landmark.h
Go to the documentation of this file.
1 /*
2  * File: landmark.h
3  * Author: Vladislav Tananaev
4  *
5  */
6 
7 #ifndef MRPT_BRIDGE_LANDMARK_H
8 #define MRPT_BRIDGE_LANDMARK_H
9 
10 #include <stdint.h>
11 #include <string>
12 
13 namespace std
14 {
15 template <class T>
16 class allocator;
17 }
18 
19 namespace geometry_msgs
20 {
21 template <class ContainerAllocator>
22 struct Pose_;
23 typedef Pose_<std::allocator<void>> Pose;
24 }
25 
26 namespace mrpt_msgs
27 {
28 template <class ContainerAllocator>
31 }
32 
33 namespace mrpt
34 {
35 namespace poses
36 {
37 class CPose3D;
38 }
39 }
40 #include <mrpt/version.h>
41 
42 namespace mrpt
43 {
44 namespace obs
45 {
46 class CObservationBearingRange;
47 }
48 }
49 
50 namespace mrpt_bridge
51 {
60 bool convert(
62  const mrpt::poses::CPose3D& _pose, mrpt::obs::CObservationBearingRange& _obj
63 
64  );
65 
71 bool convert(
72  const mrpt::obs::CObservationBearingRange& _obj,
74 
81 bool convert(
82  const mrpt::obs::CObservationBearingRange& _obj,
84 
87 } // namespace mrpt_bridge
88 
89 #endif // MRPT_BRIDGE_LANDMARK_H
ObservationRangeBearing_< std::allocator< void > > ObservationRangeBearing
Definition: landmark.h:29
bool convert(const mrpt::obs::CObservationBearingRange &_obj, mrpt_msgs::ObservationRangeBearing &_msg, geometry_msgs::Pose &_pose)
File includes methods for converting CNetworkOfPoses*DInf <=> NetworkOfPoses message types...


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