Classes | |
class | DepthImageOctomapUpdater |
class | LazyFreeSpaceUpdater |
class | OccMapTree |
class | OccupancyMapMonitor |
class | OccupancyMapUpdater |
Base class for classes which update the occupancy map. More... | |
class | PointCloudOctomapUpdater |
Typedefs | |
typedef octomap::OcTreeNode | OccMapNode |
typedef std::shared_ptr< const OccMapTree > | OccMapTreeConstPtr |
typedef std::shared_ptr< OccMapTree > | OccMapTreePtr |
typedef unsigned int | ShapeHandle |
typedef std::map< ShapeHandle, Eigen::Affine3d, std::less< ShapeHandle >, Eigen::aligned_allocator< std::pair< const ShapeHandle, Eigen::Affine3d > > > | ShapeTransformCache |
typedef boost::function< bool(const std::string &target_frame, const ros::Time &target_time, ShapeTransformCache &cache)> | TransformCacheProvider |
Functions | |
MOVEIT_CLASS_FORWARD (OccupancyMapUpdater) | |
Variables | |
static const bool | HOST_IS_BIG_ENDIAN = host_is_big_endian() |
Definition at line 47 of file occupancy_map.h.
typedef std::shared_ptr<const OccMapTree> occupancy_map_monitor::OccMapTreeConstPtr |
Definition at line 117 of file occupancy_map.h.
typedef std::shared_ptr<OccMapTree> occupancy_map_monitor::OccMapTreePtr |
Definition at line 116 of file occupancy_map.h.
typedef unsigned int occupancy_map_monitor::ShapeHandle |
Definition at line 49 of file occupancy_map_updater.h.
typedef std::map<ShapeHandle, Eigen::Affine3d, std::less<ShapeHandle>, Eigen::aligned_allocator<std::pair<const ShapeHandle, Eigen::Affine3d> > > occupancy_map_monitor::ShapeTransformCache |
Definition at line 52 of file occupancy_map_updater.h.
typedef boost::function<bool(const std::string& target_frame, const ros::Time& target_time, ShapeTransformCache& cache)> occupancy_map_monitor::TransformCacheProvider |
Definition at line 54 of file occupancy_map_updater.h.
occupancy_map_monitor::MOVEIT_CLASS_FORWARD | ( | OccupancyMapUpdater | ) |
|
static |
Definition at line 206 of file depth_image_octomap_updater.cpp.