#include <ros/ros.h>#include <ros/publisher.h>#include <sensor_msgs/Imu.h>#include <igvc/SerialPort.h>#include <vector>#include <sstream>#include <tf/transform_datatypes.h>#include <igvc/StringUtils.hpp>
Go to the source code of this file.
Macros | |
| #define | DEG_TO_RAD (3.14159265/180.0) |
| #define | GRAVITY_MSS 9.80665 |
Functions | |
| int | main (int argc, char **argv) |
| #define DEG_TO_RAD (3.14159265/180.0) |
Definition at line 11 of file ardupilot.cpp.
| #define GRAVITY_MSS 9.80665 |
Definition at line 10 of file ardupilot.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 15 of file ardupilot.cpp.