Helper class to simplify integrating the JointTrajectoryController with different hardware interfaces. More...
#include <hardware_interface_adapter.h>
Public Member Functions | |
bool | init (std::vector< typename HardwareInterface::ResourceHandleType > &, ros::NodeHandle &) |
void | starting (const ros::Time &) |
void | stopping (const ros::Time &) |
void | updateCommand (const ros::Time &, const ros::Duration &, const State &, const State &) |
Helper class to simplify integrating the JointTrajectoryController with different hardware interfaces.
Use one of the available template specializations of this class (or create your own) to adapt the JointTrajectoryController to a specidfic hardware interface.
Definition at line 57 of file hardware_interface_adapter.h.
|
inline |
Definition at line 60 of file hardware_interface_adapter.h.
|
inline |
Definition at line 65 of file hardware_interface_adapter.h.
|
inline |
Definition at line 66 of file hardware_interface_adapter.h.
|
inline |
Definition at line 68 of file hardware_interface_adapter.h.