moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
Classes | |
class | OccupancyMapMonitor |
class | OccupancyMapMonitorMiddlewareHandle |
This class contains the ros interfaces for OccupancyMapMontior. More... | |
class | OccupancyMapUpdater |
Base class for classes which update the occupancy map. More... | |
class | DepthImageOctomapUpdater |
class | LazyFreeSpaceUpdater |
class | PointCloudOctomapUpdater |
Typedefs | |
using | ShapeHandle = unsigned int |
using | ShapeTransformCache = std::map< ShapeHandle, Eigen::Isometry3d, std::less< ShapeHandle >, Eigen::aligned_allocator< std::pair< const ShapeHandle, Eigen::Isometry3d > > > |
using | TransformCacheProvider = std::function< bool(const std::string &, const rclcpp::Time &, ShapeTransformCache &)> |
Functions | |
MOVEIT_CLASS_FORWARD (OccupancyMapUpdater) | |
using occupancy_map_monitor::ShapeHandle = typedef unsigned int |
Definition at line 54 of file occupancy_map_updater.h.
using occupancy_map_monitor::ShapeTransformCache = typedef std::map<ShapeHandle, Eigen::Isometry3d, std::less<ShapeHandle>, Eigen::aligned_allocator<std::pair<const ShapeHandle, Eigen::Isometry3d> > > |
Definition at line 55 of file occupancy_map_updater.h.
using occupancy_map_monitor::TransformCacheProvider = typedef std::function<bool(const std::string&, const rclcpp::Time&, ShapeTransformCache&)> |
Definition at line 57 of file occupancy_map_updater.h.
occupancy_map_monitor::MOVEIT_CLASS_FORWARD | ( | OccupancyMapUpdater | ) |