landmark.h
Go to the documentation of this file.
1 /* +------------------------------------------------------------------------+
2  | Mobile Robot Programming Toolkit (MRPT) |
3  | http://www.mrpt.org/ |
4  | |
5  | Copyright (c) 2005-2018, Individual contributors, see AUTHORS file |
6  | See: http://www.mrpt.org/Authors - All rights reserved. |
7  | Released under BSD License. See details in http://www.mrpt.org/License |
8  +------------------------------------------------------------------------+ */
9 
10 /*
11  * File: landmark.h
12  * Author: Vladislav Tananaev
13  *
14  */
15 
16 #pragma once
17 
18 #include <cstdint>
19 #include <string>
20 
21 namespace std
22 {
23 template <class T>
24 class allocator;
25 }
26 
27 namespace geometry_msgs
28 {
29 template <class ContainerAllocator>
30 struct Pose_;
31 typedef Pose_<std::allocator<void>> Pose;
32 } // namespace geometry_msgs
33 
34 namespace mrpt_msgs
35 {
36 template <class ContainerAllocator>
39 } // namespace mrpt_msgs
40 
41 namespace mrpt
42 {
43 namespace poses
44 {
45 class CPose3D;
46 }
47 } // namespace mrpt
48 
49 namespace mrpt
50 {
51 namespace obs
52 {
53 class CObservationBearingRange;
54 }
55 } // namespace mrpt
56 
57 namespace mrpt_bridge
58 {
67 bool convert(
69  const mrpt::poses::CPose3D& _pose, mrpt::obs::CObservationBearingRange& _obj
70 
71 );
72 
78 bool convert(
79  const mrpt::obs::CObservationBearingRange& _obj,
81 
88 bool convert(
89  const mrpt::obs::CObservationBearingRange& _obj,
91 
94 } // namespace mrpt_bridge
ObservationRangeBearing_< std::allocator< void > > ObservationRangeBearing
Definition: landmark.h:37
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 Thu May 12 2022 02:26:47