point_cloud2.h
Go to the documentation of this file.
1 #ifndef MRPT_BRIDGE_POINT_CLOUD2_H
2 #define MRPT_BRIDGE_POINT_CLOUD2_H
3 
4 namespace std
5 {
6 template <class T>
7 class allocator;
8 }
9 
10 namespace std_msgs
11 {
12 template <class ContainerAllocator>
13 struct Header_;
14 typedef Header_<std::allocator<void>> Header;
15 }
16 
17 namespace sensor_msgs
18 {
19 template <class ContainerAllocator>
20 struct PointCloud2_;
22 }
23 
24 #include <mrpt/version.h>
25 namespace mrpt
26 {
27 namespace maps
28 {
29 class CSimplePointsMap;
30 class CColouredPointsMap;
31 }
32 }
33 
34 namespace mrpt_bridge
35 {
45 bool copy(
46  const sensor_msgs::PointCloud2& msg, mrpt::maps::CSimplePointsMap& obj);
47 
57 bool copy(
58  const mrpt::maps::CSimplePointsMap& obj, const std_msgs::Header& msg_header,
60 
63 } // namespace mrpt_bridge
64 
65 #endif // MRPT_BRIDGE_POINT_CLOUD2_H
PointCloud2_< std::allocator< void > > PointCloud2
Definition: point_cloud2.h:20
File includes methods for converting CNetworkOfPoses*DInf <=> NetworkOfPoses message types...
bool copy(const mrpt::maps::CSimplePointsMap &obj, const std_msgs::Header &msg_header, sensor_msgs::PointCloud2 &msg)


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