point_cloud.h
Go to the documentation of this file.
1 #ifndef MRPT_BRIDGE_POINT_CLOUD_H
2 #define MRPT_BRIDGE_POINT_CLOUD_H
3 
4 #include <sensor_msgs/PointCloud.h>
5 
6 #include <mrpt/version.h>
7 #include <mrpt/maps/CSimplePointsMap.h>
8 #include <mrpt/maps/CColouredPointsMap.h>
9 using namespace mrpt::maps;
10 
11 namespace mrpt_bridge
12 {
19 namespace point_cloud
20 {
27 bool ros2mrpt(const sensor_msgs::PointCloud& msg, CSimplePointsMap& obj);
28 
38 bool mrpt2ros(
39  const CSimplePointsMap& obj, const std_msgs::Header& msg_header,
40  sensor_msgs::PointCloud& msg);
41 } // end of PointCloud
42 
45 } // namespace mrpt_bridge
46 
47 #endif // MRPT_BRIDGE_POINT_CLOUD_H
Definition: map.h:30
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)
Definition: point_cloud.cpp:32
bool ros2mrpt(const sensor_msgs::PointCloud &msg, CSimplePointsMap &obj)
Definition: point_cloud.cpp:11


mrpt_bridge
Author(s): Markus Bader , Raphael Zack
autogenerated on Sat Apr 28 2018 02:49:17