1 #ifndef MRPT_BRIDGE_POINT_CLOUD_H 2 #define MRPT_BRIDGE_POINT_CLOUD_H 4 #include <sensor_msgs/PointCloud.h> 6 #include <mrpt/version.h> 7 #include <mrpt/maps/CSimplePointsMap.h> 8 #include <mrpt/maps/CColouredPointsMap.h> 27 bool ros2mrpt(
const sensor_msgs::PointCloud& msg, CSimplePointsMap& obj);
40 sensor_msgs::PointCloud& msg);
47 #endif // MRPT_BRIDGE_POINT_CLOUD_H
File includes methods for converting CNetworkOfPoses*DInf <=> NetworkOfPoses message types...
bool mrpt2ros(const CSimplePointsMap &obj, const std_msgs::Header &msg_header, sensor_msgs::PointCloud &msg)
bool ros2mrpt(const sensor_msgs::PointCloud &msg, CSimplePointsMap &obj)