#include "ros/ros.h"
#include "geometry_msgs/Twist.h"
#include "IMPWM.h"
#include "IMGPIO.h"
#include "IMADC.h"
#include <stdio.h>
#include <math.h>
#include <sstream>
#include <dynamic_reconfigure/server.h>
#include <evarobot_driver/ParamsConfig.h>
#include <diagnostic_updater/diagnostic_updater.h>
#include <diagnostic_updater/publisher.h>
#include "im_msgs/SetRGB.h"
#include "im_msgs/Voltage.h"
#include "im_msgs/WheelVel.h"
#include <ros/console.h>
#include "ErrorCodes.h"
#include <boost/shared_ptr.hpp>
Go to the source code of this file.
Classes | |
class | IMDRIVER |
Variables | |
bool | b_is_received_params = false |
double | g_d_max_ang |
double | g_d_max_lin |
double | g_d_wheel_diameter |
double | g_d_wheel_separation |
bool b_is_received_params = false |
Definition at line 34 of file evarobot_driver.h.
double g_d_max_ang |
Definition at line 37 of file evarobot_driver.h.
double g_d_max_lin |
Definition at line 36 of file evarobot_driver.h.
double g_d_wheel_diameter |
Definition at line 39 of file evarobot_driver.h.
double g_d_wheel_separation |
Definition at line 38 of file evarobot_driver.h.