#include <sensor_msgs/PointCloud2.h>
#include <pcl/point_cloud.h>
#include <pcl/point_types.h>
#include <pcl/ros/conversions.h>
#include <tf/transform_datatypes.h>
#include <geometry_msgs/Point.h>
#include <geometry_msgs/Vector3.h>
#include <octomap/octomap.h>
#include <octomap_ros/conversions.h>
Go to the source code of this file.
Classes | |
class | octomap::ButOctomapROS< OctreeT > |
ROS wrapper class for OctoMap Octrees, providing the most important functionality with ROS / PCL types. The class is templated over the Octree type. Any OcTree derived from octomap::OccupancyOcTreeBase should work. For most cases, OcTreeROS should work best for occupancy maps. More... | |
Namespaces | |
namespace | octomap |
Typedefs | |
typedef ButOctomapROS< OcTree > | octomap::OcTreeROS |
The default octomap::OcTree wrapped in ROS. OcTree provides a 3D occupancy map which stores log-odds in OcTreeNodes of floats. |