#include "ros/ros.h"#include "sensor_msgs/Imu.h"#include "geometry_msgs/Quaternion.h"#include "geometry_msgs/Vector3.h"#include "nav_msgs/Odometry.h"#include "IMUM6.h"#include <sstream>#include <diagnostic_updater/diagnostic_updater.h>#include <diagnostic_updater/publisher.h>#include <ros/console.h>#include <ErrorCodes.h>

Go to the source code of this file.
| Defines | |
| #define | BAUDRATE B115200 | 
| #define | DATABITS CS8 | 
| #define | PARITY 0 | 
| #define | SERIAL_PATH "/dev/ttyAMA0" | 
| #define | STOP_BITS 0 | 
| #define BAUDRATE B115200 | 
Definition at line 30 of file evarobot_orientation.h.
| #define DATABITS CS8 | 
Definition at line 31 of file evarobot_orientation.h.
| #define PARITY 0 | 
Definition at line 36 of file evarobot_orientation.h.
| #define SERIAL_PATH "/dev/ttyAMA0" | 
Definition at line 29 of file evarobot_orientation.h.
| #define STOP_BITS 0 | 
Definition at line 37 of file evarobot_orientation.h.