#include <ros/ros.h>#include <std_msgs/ColorRGBA.h>#include <sensor_msgs/JointState.h>#include <geometry_msgs/Twist.h>#include <nav_msgs/Odometry.h>#include <urdf/model.h>#include <kdl_parser/kdl_parser.hpp>#include <kdl/chainfksolvervel_recursive.hpp>#include <kdl/jntarray.hpp>#include <kdl/jntarrayvel.hpp>#include <kdl/frames.hpp>#include <tf/transform_listener.h>#include <tf/tf.h>#include <boost/thread/mutex.hpp>#include <boost/shared_ptr.hpp>#include <dynamic_reconfigure/server.h>#include <pluginlib/class_loader.h>#include <cob_twist_controller/TwistControllerConfig.h>#include "cob_twist_controller/cob_twist_controller_data_types.h"#include <cob_twist_controller/inverse_differential_kinematics_solver.h>#include "cob_twist_controller/controller_interfaces/controller_interface_base.h"#include "cob_twist_controller/callback_data_mediator.h"

Go to the source code of this file.
Classes | |
| class | CobTwistController |