#include "ros/ros.h"#include <realtime_tools/realtime_publisher.h>#include "vector.h"#include "MinIMU9.h"#include "version.h"#include <iostream>#include <iomanip>#include <stdio.h>#include <stdlib.h>#include <time.h>#include <sys/time.h>#include <system_error>#include <boost/program_options.hpp>#include <diagnostic_updater/diagnostic_updater.h>#include <diagnostic_updater/publisher.h>#include "sensor_msgs/Imu.h"#include <sys/types.h>#include <sys/ipc.h>#include <semaphore.h>#include <sys/stat.h>#include <fcntl.h>#include <sstream>#include <ros/console.h>#include "ErrorCodes.h"

Go to the source code of this file.
Defines | |
| #define | FLOAT_FORMAT std::fixed << std::setprecision(3) << std::setw(field_width) |
Variables | |
| float | field_width = 6 |
| char | SEM_NAME [] = "i2c" |
| #define FLOAT_FORMAT std::fixed << std::setprecision(3) << std::setw(field_width) |
Definition at line 48 of file evarobot_minimu9.h.
| float field_width = 6 |
Definition at line 47 of file evarobot_minimu9.h.
| char SEM_NAME[] = "i2c" |
Definition at line 40 of file evarobot_minimu9.h.