#include "ros/ros.h"#include <realtime_tools/realtime_publisher.h>#include "geometry_msgs/PointStamped.h"#include "geometry_msgs/Twist.h"#include <diagnostic_updater/diagnostic_updater.h>#include <diagnostic_updater/publisher.h>#include "std_srvs/Empty.h"#include "im_msgs/WheelVel.h"#include <stdio.h>#include <stdlib.h>#include <string>#include <sstream>#include <ros/console.h>#include <ErrorCodes.h>

Go to the source code of this file.
Classes | |
| class | PIDController |
Variables | |
| bool | b_is_received_params = false |
| bool | b_reset_controller = false |
| double | g_d_d_left |
| double | g_d_d_right |
| double | g_d_dt = 0 |
| double | g_d_i_left |
| double | g_d_i_right |
| double | g_d_p_left |
| double | g_d_p_right |
| double | g_d_wheel_separation |
| float | g_f_left_desired = 0.0 |
| float | g_f_left_measured = 0.0 |
| float | g_f_right_desired = 0.0 |
| float | g_f_right_measured = 0.0 |
| bool b_is_received_params = false |
Definition at line 32 of file evarobot_controller.h.
| bool b_reset_controller = false |
Definition at line 34 of file evarobot_controller.h.
| double g_d_d_left |
Definition at line 40 of file evarobot_controller.h.
| double g_d_d_right |
Definition at line 44 of file evarobot_controller.h.
| double g_d_dt = 0 |
Definition at line 46 of file evarobot_controller.h.
| double g_d_i_left |
Definition at line 39 of file evarobot_controller.h.
| double g_d_i_right |
Definition at line 43 of file evarobot_controller.h.
| double g_d_p_left |
Definition at line 38 of file evarobot_controller.h.
| double g_d_p_right |
Definition at line 42 of file evarobot_controller.h.
| double g_d_wheel_separation |
Definition at line 31 of file evarobot_controller.h.
| float g_f_left_desired = 0.0 |
Definition at line 25 of file evarobot_controller.h.
| float g_f_left_measured = 0.0 |
Definition at line 28 of file evarobot_controller.h.
| float g_f_right_desired = 0.0 |
Definition at line 26 of file evarobot_controller.h.
| float g_f_right_measured = 0.0 |
Definition at line 29 of file evarobot_controller.h.