#include <ros/ros.h>#include <std_msgs/Float64.h>#include <std_srvs/Empty.h>#include <controller_manager/controller_manager.h>#include <hardware_interface/joint_command_interface.h>#include <hardware_interface/joint_state_interface.h>#include <hardware_interface/robot_hw.h>#include <realtime_tools/realtime_buffer.h>#include <limits>#include <sstream>

Go to the source code of this file.
Classes | |
| class | AckermannSteeringBot |
Enumerations | |
| enum | INDEX_WHEEL { INDEX_RIGHT = 0, INDEX_LEFT = 1 } |
| enum INDEX_WHEEL |
| Enumerator | |
|---|---|
| INDEX_RIGHT | |
| INDEX_LEFT | |
Definition at line 50 of file ackermann_steering_bot.h.