#include <sensor_msgs/PointCloud.h>
#include <mrpt/version.h>
#include <mrpt/maps/CSimplePointsMap.h>
#include <mrpt/maps/CColouredPointsMap.h>
Go to the source code of this file.
Namespaces | |
mrpt_bridge | |
File includes methods for converting CNetworkOfPoses*DInf <=> NetworkOfPoses message types. | |
mrpt_bridge::point_cloud | |
Functions | |
bool | mrpt_bridge::point_cloud::mrpt2ros (const mrpt::maps::CSimplePointsMap &obj, const std_msgs::Header &msg_header, sensor_msgs::PointCloud &msg) |
bool | mrpt_bridge::point_cloud::ros2mrpt (const sensor_msgs::PointCloud &msg, mrpt::maps::CSimplePointsMap &obj) |