marker_msgs.h
Go to the documentation of this file.
1 /* +------------------------------------------------------------------------+
2  | Mobile Robot Programming Toolkit (MRPT) |
3  | https://www.mrpt.org/ |
4  | |
5  | Copyright (c) 2005-2022, Individual contributors, see AUTHORS file |
6  | See: https://www.mrpt.org/Authors - All rights reserved. |
7  | Released under BSD License. See: https://www.mrpt.org/License |
8  +------------------------------------------------------------------------+ */
9 
17 #pragma once
18 
19 #include <geometry_msgs/Pose.h>
20 #include <marker_msgs/MarkerDetection.h>
21 #include <mrpt/obs/CObservation2DRangeScan.h>
22 #include <mrpt/obs/CObservationBeaconRanges.h>
23 #include <mrpt/obs/CObservationBearingRange.h>
24 #include <mrpt/obs/CObservationRange.h>
25 #include <mrpt/poses/CPose3D.h>
26 
27 namespace mrpt_msgs_bridge
28 {
29 // NOTE: These converters are here instead of mrpt::ros1bridge since
30 // the builds dep. MarkerDetection is not available in Debian/Ubuntu
31 // official repos, so we need to build it here within ROS.
32 
33 bool fromROS(
34  const marker_msgs::MarkerDetection& _msg,
35  const mrpt::poses::CPose3D& sensorPoseOnRobot,
36  mrpt::obs::CObservationBearingRange& _obj);
37 
38 bool fromROS(
39  const marker_msgs::MarkerDetection& _msg,
40  const mrpt::poses::CPose3D& sensorPoseOnRobot,
41  mrpt::obs::CObservationBeaconRanges& _obj);
42 
43 } // namespace mrpt_msgs_bridge
File includes methods for converting CNetworkOfPoses*DInf <=> NetworkOfPoses message types...
Definition: beacon.h:20
bool fromROS(const mrpt_msgs::ObservationRangeBeacon &_msg, const mrpt::poses::CPose3D &_pose, mrpt::obs::CObservationBeaconRanges &_obj)


mrpt_msgs_bridge
Author(s): José Luis Blanco-Claraco
autogenerated on Thu Jun 1 2023 03:07:04