| 
    moveit2
    
   The MoveIt Motion Planning Framework for ROS 2. 
   | 
 
#include <moveit/macros/class_forward.h>#include <moveit/collision_detection/occupancy_map.h>#include <geometric_shapes/shapes.h>#include <rclcpp/rclcpp.hpp>#include <Eigen/Core>#include <Eigen/Geometry>#include <map>#include <string>#include <functional>

Go to the source code of this file.
Classes | |
| class | occupancy_map_monitor::OccupancyMapUpdater | 
| Base class for classes which update the occupancy map.  More... | |
Namespaces | |
| occupancy_map_monitor | |
Typedefs | |
| using | occupancy_map_monitor::ShapeHandle = unsigned int | 
| using | occupancy_map_monitor::ShapeTransformCache = std::map< ShapeHandle, Eigen::Isometry3d, std::less< ShapeHandle >, Eigen::aligned_allocator< std::pair< const ShapeHandle, Eigen::Isometry3d > > > | 
| using | occupancy_map_monitor::TransformCacheProvider = std::function< bool(const std::string &, const rclcpp::Time &, ShapeTransformCache &)> | 
Functions | |
| occupancy_map_monitor::MOVEIT_CLASS_FORWARD (OccupancyMapUpdater) | |