#include <sensor_msgs/PointCloud2.h>#include <string>#include <vector>#include <ostream>#include "ros/serialization.h"#include "ros/builtin_message_traits.h"#include "ros/message_operations.h"#include "ros/message.h"#include "ros/time.h"#include "std_msgs/Header.h"#include "sensor_msgs/PointField.h"#include <pcl/point_cloud.h>#include <pcl/point_types.h>#include <sensor_msgs/PointCloud2.h>#include "pcl/ros/point_traits.h"#include <boost/mpl/is_sequence.hpp>#include <boost/mpl/begin_end.hpp>#include <boost/mpl/next_prior.hpp>#include <boost/mpl/deref.hpp>#include <boost/mpl/assert.hpp>#include <boost/mpl/aux_/unwrap.hpp>#include <boost/type_traits/is_same.hpp>#include "pcl/exceptions.h"#include <boost/foreach.hpp>#include <tf/transform_datatypes.h>#include <geometry_msgs/Point.h>#include <geometry_msgs/Vector3.h>#include <octomap/octomap.h>#include <octomap_ros/OctomapBinary.h>

Go to the source code of this file.
Classes | |
| class | octomap::OctomapROS< 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 OctomapROS< OcTree > | octomap::OcTreeROS |
| The default octomap::OcTree wrapped in ROS. OcTree provides a 3D occupancy map which stores log-odds in OcTreeNodes of floats. | |