16 #ifndef MRPT_BRIDGE_GPS_H 17 #define MRPT_BRIDGE_GPS_H 20 #include <sensor_msgs/NavSatFix.h> 21 #include <mrpt/obs/CObservationGPS.h> 36 bool ros2mrpt(
const sensor_msgs::NavSatFix &msg,
37 CObservationGPS &obj);
47 bool mrpt2ros(
const CObservationGPS &obj,
49 sensor_msgs::NavSatFix &msg);
54 #endif //MRPT_BRIDGE_GPS_H bool mrpt2ros(const CObservationGPS &obj, const std_msgs::Header &msg_header, sensor_msgs::NavSatFix &msg)
File includes methods for converting CNetworkOfPoses*DInf <=> NetworkOfPoses message types...
bool ros2mrpt(const sensor_msgs::NavSatFix &msg, CObservationGPS &obj)