#include <ros/ros.h>#include <sensor_msgs/NavSatFix.h>
Go to the source code of this file.
Functions | |
| char | get_solution (double &lat, double &lon, double &height) | 
| int | main (int argc, char **argv) | 
| int | start_rtkrcv (int argc, char **argv) | 
| void | stop_rtkrcv () | 
| char get_solution | ( | double & | lat, | 
| double & | lon, | ||
| double & | height | ||
| ) | 
Definition at line 550 of file rtkrcv.cpp.
| int start_rtkrcv | ( | int | argc, | 
| char ** | argv | ||
| ) | 
Definition at line 493 of file rtkrcv.cpp.
| void stop_rtkrcv | ( | ) | 
Definition at line 534 of file rtkrcv.cpp.