39 #include <rclcpp/clock.hpp>
40 #include <rclcpp/logger.hpp>
41 #include <rclcpp/logging.hpp>
46 static const rclcpp::Logger
LOGGER = rclcpp::get_logger(
"moveit.ros.occupancy_map_updater");
88 rclcpp::Clock steady_clock(RCL_STEADY_TIME);
89 RCLCPP_ERROR_THROTTLE(
90 LOGGER, steady_clock, 1000,
91 "Transform cache was not updated. Self-filtering may fail. If transforms were not available yet, consider "
92 "setting robot_description_planning.shape_transform_cache_lookup_wait_time to wait longer for transforms");
98 rclcpp::Clock steady_clock(RCL_STEADY_TIME);
99 RCLCPP_WARN_THROTTLE(LOGGER, steady_clock, 1000,
100 "No callback provided for updating the transform cache for octomap updaters");
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)
const rclcpp::Logger LOGGER