Class providing a ControllerInterface publishing velocities. More...
#include <controller_interface.h>
Public Member Functions | |
ControllerInterfaceVelocity () | |
virtual void | initialize (ros::NodeHandle &nh, const TwistControllerParams ¶ms) |
virtual void | processResult (const KDL::JntArray &q_dot_ik, const KDL::JntArray ¤t_q) |
~ControllerInterfaceVelocity () | |
Public Member Functions inherited from cob_twist_controller::ControllerInterfaceBase | |
virtual | ~ControllerInterfaceBase () |
Additional Inherited Members | |
Protected Member Functions inherited from cob_twist_controller::ControllerInterfaceBase | |
ControllerInterfaceBase () | |
Protected Attributes inherited from cob_twist_controller::ControllerInterfaceBase | |
ros::NodeHandle | nh_ |
TwistControllerParams | params_ |
ros::Publisher | pub_ |
Class providing a ControllerInterface publishing velocities.
Definition at line 38 of file controller_interface.h.
|
inline |
Definition at line 41 of file controller_interface.h.
|
inline |
Definition at line 42 of file controller_interface.h.
|
virtual |
Implements cob_twist_controller::ControllerInterfaceBase.
Definition at line 26 of file controller_interface.cpp.
|
inlinevirtual |
Method processing the result by publishing to the 'joint_group_velocity_controller/command' topic.
Implements cob_twist_controller::ControllerInterfaceBase.
Definition at line 36 of file controller_interface.cpp.