Function octomap::pointsOctomapToPointCloud2
- Defined in File conversions.hpp 
Function Documentation
- 
void octomap::pointsOctomapToPointCloud2(const octomap::point3d_list &points, sensor_msgs::msg::PointCloud2 &cloud)
- Conversion from octomap::point3d_list (e.g. all occupied nodes from getOccupied()) to sensor_msgs::PointCloud2. - Parameters:
- points – 
- cloud –