#include <math.h>
#include <angles/angles.h>
#include <boost/scoped_ptr.hpp>
#include <boost/thread/mutex.hpp>
#include <controller_interface/multi_interface_controller.h>
#include <hardware_interface/joint_command_interface.h>
#include <realtime_tools/realtime_publisher.h>
#include <cob_tricycle_controller/param_parser.h>
#include <cob_base_controller_utils/WheelCommands.h>
#include <geometry_msgs/Twist.h>
#include <cob_tricycle_controller/TricycleCtrlTypes.h>
#include <pluginlib/class_list_macros.h>
Go to the source code of this file.
Classes | |
struct | cob_tricycle_controller::WheelController::Target |
class | cob_tricycle_controller::WheelController |
Namespaces | |
cob_tricycle_controller | |
Functions | |
double | cob_tricycle_controller::limitValue (double value, double limit) |