#include <sensor_msgs/Range.h>
#include <mrpt/obs/CObservationRange.h>
Go to the source code of this file.
Namespaces | |
namespace | mrpt_bridge |
File includes methods for converting CNetworkOfPoses*DInf <=> NetworkOfPoses message types. | |
namespace | mrpt_bridge::range |
Functions | |
bool | mrpt_bridge::range::mrpt2ros (const CObservationRange &obj, const std_msgs::Header &msg_header, sensor_msgs::Range *msg) |
bool | mrpt_bridge::range::ros2mrpt (const sensor_msgs::Range &msg, CObservationRange &obj) |