odometry_serialcom.h
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 #include "nav_msgs/Odometry.h"
00007 #include "geometry_msgs/Vector3.h"
00008 #include "geometry_msgs/Pose2D.h"
00009 #include "geometry_msgs/PointStamped.h"
00010 #include "std_srvs/Empty.h"
00011 #include <tf/transform_broadcaster.h>
00012 //#include "im_msgs/WheelVel.h"
00013 
00014 
00015 #include <string>    
00016 #include <sstream>
00017 
00018 #include <math.h>
00019 
00020 #include <ros/console.h>
00021 //#include <ErrorCodes.h>
00022 //the serial port
00023 #include <stdio.h>
00024 #include <string.h>
00025 #include <sys/types.h>
00026 #include <errno.h>
00027 #include <sys/stat.h>
00028 #include <fcntl.h>
00029 #include <unistd.h>
00030 #include <termios.h>
00031 #include <stdlib.h>
00032 #define PI 3.1416
00033 
00034 using namespace std;
00035 
00036 #endif


odometry_serialcom
Author(s):
autogenerated on Thu Jun 6 2019 18:00:10