Go to the documentation of this file.00001
00002
00003
00004
00005
00006
00007
00008
00009
00010
00011
00012
00013
00014
00015
00016 #ifndef MRPT_BRIDGE_GPS_H
00017 #define MRPT_BRIDGE_GPS_H
00018
00019
00020 #include <sensor_msgs/NavSatFix.h>
00021 #include <mrpt/obs/CObservationGPS.h>
00022
00023 using namespace mrpt::obs;
00024
00027
00028 namespace mrpt_bridge
00029 {
00030 namespace GPS
00031 {
00036 bool ros2mrpt(const sensor_msgs::NavSatFix &msg,
00037 CObservationGPS &obj);
00038
00039
00047 bool mrpt2ros(const CObservationGPS &obj,
00048 const std_msgs::Header &msg_header,
00049 sensor_msgs::NavSatFix &msg);
00050 }
00051 }
00052
00053
00054 #endif //MRPT_BRIDGE_GPS_H