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>
34 const marker_msgs::MarkerDetection& _msg,
35 const mrpt::poses::CPose3D& sensorPoseOnRobot,
36 mrpt::obs::CObservationBearingRange& _obj);
39 const marker_msgs::MarkerDetection& _msg,
40 const mrpt::poses::CPose3D& sensorPoseOnRobot,
41 mrpt::obs::CObservationBeaconRanges& _obj);