#include <geometry_msgs/Pose.h>
#include "mrpt_bridge/time.h"
#include "mrpt_bridge/pose.h"
#include <mrpt_msgs/ObservationRangeBeacon.h>
#include "tf/transform_datatypes.h"
#include "tf/LinearMath/Matrix3x3.h"
#include "mrpt_bridge/beacon.h"
#include <mrpt/version.h>
#include <mrpt/obs/CObservationBeaconRanges.h>
Go to the source code of this file.
Namespaces | |
mrpt_bridge | |
File includes methods for converting CNetworkOfPoses*DInf <=> NetworkOfPoses message types. | |
Functions | |
bool | mrpt_bridge::convert (const mrpt_msgs::ObservationRangeBeacon &_msg, const mrpt::poses::CPose3D &_pose, CObservationBeaconRanges &_obj) |
bool | mrpt_bridge::convert (const CObservationBeaconRanges &_obj, mrpt_msgs::ObservationRangeBeacon &_msg) |
bool | mrpt_bridge::convert (const CObservationBeaconRanges &_obj, mrpt_msgs::ObservationRangeBeacon &_msg, geometry_msgs::Pose &_pose) |