marker_msgs.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 
17 #pragma once
18 
19 #include <marker_msgs/MarkerDetection.h>
20 #include <mrpt/obs/CObservationRange.h>
21 #include <mrpt/obs/CObservation2DRangeScan.h>
22 #include <mrpt/obs/CObservationBearingRange.h>
23 #include <mrpt/obs/CObservationBeaconRanges.h>
24 
25 namespace std
26 {
27 template <class T>
28 class allocator;
29 }
30 
31 namespace geometry_msgs
32 {
33 template <class ContainerAllocator>
34 struct Pose_;
35 typedef Pose_<std::allocator<void>> Pose;
36 } // namespace geometry_msgs
37 
38 namespace marker_msgs
39 {
40 template <class ContainerAllocator>
43 } // namespace marker_msgs
44 
45 namespace mrpt
46 {
47 namespace poses
48 {
49 class CPose3D;
50 }
51 } // namespace mrpt
52 
53 namespace mrpt
54 {
55 namespace obs
56 {
57 class CObservationBearingRange;
58 }
59 } // namespace mrpt
60 
61 namespace mrpt_bridge
62 {
63 bool convert(
64  const marker_msgs::MarkerDetection& _msg, const mrpt::poses::CPose3D& _pose,
65  mrpt::obs::CObservationBearingRange& _obj);
66 bool convert(
67  const marker_msgs::MarkerDetection& _msg, const mrpt::poses::CPose3D& _pose,
68  mrpt::obs::CObservationBeaconRanges& _obj);
69 } // namespace mrpt_bridge
MarkerDetection_< std::allocator< void > > MarkerDetection
Definition: marker_msgs.h:41
File includes methods for converting CNetworkOfPoses*DInf <=> NetworkOfPoses message types...
bool convert(const marker_msgs::MarkerDetection &_msg, const mrpt::poses::CPose3D &_pose, mrpt::obs::CObservationBeaconRanges &_obj)
Definition: marker_msgs.cpp:58


mrpt_bridge
Author(s): Markus Bader , Raphael Zack
autogenerated on Thu May 12 2022 02:26:47