Go to the documentation of this file.00001 #ifndef INCLUDE_EVAROBOT_ODOMETRY_H_
00002 #define INCLUDE_EVAROBOT_ODOMETRY_H_
00003
00004 #include "ros/ros.h"
00005 #include <realtime_tools/realtime_publisher.h>
00006
00007 #include "nav_msgs/Odometry.h"
00008 #include "geometry_msgs/Vector3.h"
00009 #include "geometry_msgs/Pose2D.h"
00010
00011 #include "geometry_msgs/PointStamped.h"
00012 #include "std_srvs/Empty.h"
00013 #include "im_msgs/WheelVel.h"
00014
00015 #include <diagnostic_updater/diagnostic_updater.h>
00016 #include <diagnostic_updater/publisher.h>
00017
00018 #include <string>
00019 #include <sstream>
00020
00021 #include <stdio.h>
00022 #include <stdlib.h>
00023 #include <fcntl.h>
00024 #include <math.h>
00025
00026 #include <ros/console.h>
00027 #include <ErrorCodes.h>
00028
00029 #define PI 3.1416
00030
00031 using namespace std;
00032
00033 #endif