39 #include <rclcpp/clock.hpp>
40 #include <rclcpp/logger.hpp>
41 #include <rclcpp/logging.hpp>
95 rclcpp::Clock steady_clock(RCL_STEADY_TIME);
96 #pragma GCC diagnostic push
97 #pragma GCC diagnostic ignored "-Wold-style-cast"
98 RCLCPP_ERROR_THROTTLE(
100 "Transform cache was not updated. Self-filtering may fail. If transforms were not available yet, consider "
101 "setting robot_description_planning.shape_transform_cache_lookup_wait_time to wait longer for transforms");
102 #pragma GCC diagnostic pop
108 rclcpp::Clock steady_clock(RCL_STEADY_TIME);
109 #pragma GCC diagnostic push
110 #pragma GCC diagnostic ignored "-Wold-style-cast"
111 RCLCPP_WARN_THROTTLE(
getLogger(), steady_clock, 1000,
112 "No callback provided for updating the transform cache for octomap updaters");
113 #pragma GCC diagnostic pop
const collision_detection::OccMapTreePtr & getOcTreePtr()
Get a pointer to the underlying octree for this monitor. Lock the tree before reading or writing usin...
TransformCacheProvider transform_provider_callback_
virtual ~OccupancyMapUpdater()
OccupancyMapMonitor * monitor_
collision_detection::OccMapTreePtr tree_
ShapeTransformCache transform_cache_
bool updateTransformCache(const std::string &target_frame, const rclcpp::Time &target_time)
void setMonitor(OccupancyMapMonitor *monitor)
This is the first function to be called after construction.
OccupancyMapUpdater(const std::string &type)
rclcpp::Logger getLogger()
rclcpp::Logger getLogger(const std::string &name)
Creates a namespaced logger.