Go to the documentation of this file.00001 #ifndef INCLUDE_EVAROBOT_MINIMU_H_
00002 #define INCLUDE_EVAROBOT_MINIMU_H_
00003
00004 #include "ros/ros.h"
00005 #include <realtime_tools/realtime_publisher.h>
00006
00007 #include "vector.h"
00008 #include "MinIMU9.h"
00009 #include "version.h"
00010
00011 #include <iostream>
00012 #include <iomanip>
00013 #include <stdio.h>
00014 #include <stdlib.h>
00015 #include <time.h>
00016
00017 #include <sys/time.h>
00018 #include <system_error>
00019 #include <boost/program_options.hpp>
00020
00021 #include <diagnostic_updater/diagnostic_updater.h>
00022 #include <diagnostic_updater/publisher.h>
00023
00024 #include "sensor_msgs/Imu.h"
00025
00026 #include <sys/types.h>
00027 #include <sys/ipc.h>
00028 #include <semaphore.h>
00029 #include <sys/stat.h>
00030 #include <fcntl.h>
00031
00032 #include <sstream>
00033
00034 #include <ros/console.h>
00035 #include "ErrorCodes.h"
00036
00037
00038
00039
00040 char SEM_NAME[]= "i2c";
00041
00042 namespace opts = boost::program_options;
00043
00044
00045
00046
00047 float field_width = 6;
00048 #define FLOAT_FORMAT std::fixed << std::setprecision(3) << std::setw(field_width)
00049
00050 #endif