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 55 of file hardware_interface_adapter.h.
bool HardwareInterfaceAdapter< HardwareInterface, State >::init | ( | std::vector< typename HardwareInterface::ResourceHandleType > & | , |
ros::NodeHandle & | |||
) | [inline] |
Definition at line 58 of file hardware_interface_adapter.h.
void HardwareInterfaceAdapter< HardwareInterface, State >::starting | ( | const ros::Time & | ) | [inline] |
Definition at line 63 of file hardware_interface_adapter.h.
void HardwareInterfaceAdapter< HardwareInterface, State >::stopping | ( | const ros::Time & | ) | [inline] |
Definition at line 64 of file hardware_interface_adapter.h.
void HardwareInterfaceAdapter< HardwareInterface, State >::updateCommand | ( | const ros::Time & | , |
const ros::Duration & | , | ||
const State & | , | ||
const State & | |||
) | [inline] |
Definition at line 66 of file hardware_interface_adapter.h.