Funtions to convert marker_msgs to mrpt msgs. More...
#include <geometry_msgs/Pose.h>
#include <marker_msgs/MarkerDetection.h>
#include <mrpt/obs/CObservation2DRangeScan.h>
#include <mrpt/obs/CObservationBeaconRanges.h>
#include <mrpt/obs/CObservationBearingRange.h>
#include <mrpt/obs/CObservationRange.h>
#include <mrpt/poses/CPose3D.h>
Go to the source code of this file.
Namespaces | |
mrpt_msgs_bridge | |
File includes methods for converting CNetworkOfPoses*DInf <=> NetworkOfPoses message types. | |
Functions | |
bool | mrpt_msgs_bridge::fromROS (const marker_msgs::MarkerDetection &_msg, const mrpt::poses::CPose3D &sensorPoseOnRobot, mrpt::obs::CObservationBearingRange &_obj) |
bool | mrpt_msgs_bridge::fromROS (const marker_msgs::MarkerDetection &_msg, const mrpt::poses::CPose3D &sensorPoseOnRobot, mrpt::obs::CObservationBeaconRanges &_obj) |