18 #ifndef COB_TWIST_CONTROLLER_CONTROLLER_INTERFACES_CONTROLLER_INTERFACE_H 19 #define COB_TWIST_CONTROLLER_CONTROLLER_INTERFACES_CONTROLLER_INTERFACE_H 21 #include <sensor_msgs/JointState.h> 22 #include <std_msgs/Float64MultiArray.h> 23 #include <trajectory_msgs/JointTrajectory.h> 25 #include <boost/thread/mutex.hpp> 107 #endif // COB_TWIST_CONTROLLER_CONTROLLER_INTERFACES_CONTROLLER_INTERFACE_H
~ControllerInterfaceVelocity()
~ControllerInterfacePosition()
sensor_msgs::JointState js_msg_
Base class for controller interfaces using position integration.
ControllerInterfaceTrajectory()
Class providing a ControllerInterface publishing JointStates.
virtual void processResult(const KDL::JntArray &q_dot_ik, const KDL::JntArray ¤t_q)
virtual void initialize(ros::NodeHandle &nh, const TwistControllerParams ¶ms)
Base class for controller interfaces.
ControllerInterfaceVelocity()
Class providing a ControllerInterface publishing JointGroupPositionCommands.
~ControllerInterfaceJointStates()
Class providing a ControllerInterface publishing velocities.
ControllerInterfacePosition()
~ControllerInterfaceTrajectory()
ControllerInterfaceJointStates()
Class providing a ControllerInterface publishing a JointTrajectory.