#include <ublox_gps/gps.h>#include <boost/asio/serial_port.hpp>#include <boost/asio/ip/tcp.hpp>#include <boost/regex.hpp>#include <ros/ros.h>#include <ublox_msgs/ublox_msgs.h>#include <sensor_msgs/NavSatFix.h>#include <geometry_msgs/Vector3Stamped.h>
Go to the source code of this file.
Functions | |
| int | main (int argc, char **argv) |
| void | pollMessages (const ros::TimerEvent &event) |
| template<typename MessageT > | |
| void | publish (const MessageT &m, const std::string &topic) |
| void | publishAidALM (const ublox_msgs::AidALM &m) |
| void | publishAidEPH (const ublox_msgs::AidEPH &m) |
| void | publishAidHUI (const ublox_msgs::AidHUI &m) |
| void | publishNavCLK (const ublox_msgs::NavCLOCK &m) |
| void | publishNavPosLLH (const ublox_msgs::NavPOSLLH &m) |
| void | publishNavSOL (const ublox_msgs::NavSOL &m) |
| void | publishNavStatus (const ublox_msgs::NavSTATUS &m) |
| void | publishNavSVINFO (const ublox_msgs::NavSVINFO &m) |
| void | publishNavVelNED (const ublox_msgs::NavVELNED &m) |
| void | publishRxmALM (const ublox_msgs::RxmALM &m) |
| void | publishRxmEPH (const ublox_msgs::RxmEPH &m) |
| void | publishRxmRAW (const ublox_msgs::RxmRAW &m) |
| void | publishRxmSFRB (const ublox_msgs::RxmSFRB &m) |
Variables | |
| std::map< std::string, bool > | enabled |
| sensor_msgs::NavSatFix | fix |
| std::string | frame_id |
| Gps | gps |
| ros::NodeHandle * | nh |
| ublox_msgs::NavSTATUS | status |
| geometry_msgs::Vector3Stamped | velocity |
| void pollMessages | ( | const ros::TimerEvent & | event | ) |
| void publish | ( | const MessageT & | m, |
| const std::string & | topic | ||
| ) |
| void publishAidALM | ( | const ublox_msgs::AidALM & | m | ) |
| void publishAidEPH | ( | const ublox_msgs::AidEPH & | m | ) |
| void publishAidHUI | ( | const ublox_msgs::AidHUI & | m | ) |
| void publishNavCLK | ( | const ublox_msgs::NavCLOCK & | m | ) |
| void publishNavPosLLH | ( | const ublox_msgs::NavPOSLLH & | m | ) |
| void publishNavSOL | ( | const ublox_msgs::NavSOL & | m | ) |
| void publishNavStatus | ( | const ublox_msgs::NavSTATUS & | m | ) |
| void publishNavSVINFO | ( | const ublox_msgs::NavSVINFO & | m | ) |
| void publishNavVelNED | ( | const ublox_msgs::NavVELNED & | m | ) |
| void publishRxmALM | ( | const ublox_msgs::RxmALM & | m | ) |
| void publishRxmEPH | ( | const ublox_msgs::RxmEPH & | m | ) |
| void publishRxmRAW | ( | const ublox_msgs::RxmRAW & | m | ) |
| void publishRxmSFRB | ( | const ublox_msgs::RxmSFRB & | m | ) |