Go to the source code of this file.
Namespaces | |
namespace | octomap |
Functions | |
void | octomap::pointCloud2ToOctomap (const sensor_msgs::PointCloud2 &cloud, Pointcloud &octomapCloud) |
Conversion from a sensor_msgs::PointCLoud2 to octomap::Pointcloud, used internally in OctoMap. | |
void | octomap::pointsOctomapToPointCloud2 (const point3d_list &points, sensor_msgs::PointCloud2 &cloud) |
Conversion from octomap::point3d_list (e.g. all occupied nodes from getOccupied()) to sensor_msgs::PointCloud2. |