Public Member Functions | Private Attributes | List of all members
HardwareInterfaceAdapter< hardware_interface::PosVelJointInterface, State > Class Template Reference

Adapter for a pos-vel hardware interface. Forwards desired positions with velcities as commands. More...

#include <hardware_interface_adapter.h>

Public Member Functions

 HardwareInterfaceAdapter ()
 
bool init (std::vector< hardware_interface::PosVelJointHandle > &joint_handles, ros::NodeHandle &)
 
void starting (const ros::Time &)
 
void stopping (const ros::Time &)
 
void updateCommand (const ros::Time &, const ros::Duration &, const State &desired_state, const State &)
 

Private Attributes

std::vector< hardware_interface::PosVelJointHandle > * joint_handles_ptr_
 

Detailed Description

template<class State>
class HardwareInterfaceAdapter< hardware_interface::PosVelJointInterface, State >

Adapter for a pos-vel hardware interface. Forwards desired positions with velcities as commands.

Definition at line 291 of file hardware_interface_adapter.h.

Constructor & Destructor Documentation

Definition at line 294 of file hardware_interface_adapter.h.

Member Function Documentation

template<class State >
bool HardwareInterfaceAdapter< hardware_interface::PosVelJointInterface, State >::init ( std::vector< hardware_interface::PosVelJointHandle > &  joint_handles,
ros::NodeHandle  
)
inline

Definition at line 296 of file hardware_interface_adapter.h.

template<class State >
void HardwareInterfaceAdapter< hardware_interface::PosVelJointInterface, State >::starting ( const ros::Time )
inline

Definition at line 304 of file hardware_interface_adapter.h.

template<class State >
void HardwareInterfaceAdapter< hardware_interface::PosVelJointInterface, State >::stopping ( const ros::Time )
inline

Definition at line 305 of file hardware_interface_adapter.h.

template<class State >
void HardwareInterfaceAdapter< hardware_interface::PosVelJointInterface, State >::updateCommand ( const ros::Time ,
const ros::Duration ,
const State &  desired_state,
const State &   
)
inline

Definition at line 307 of file hardware_interface_adapter.h.

Member Data Documentation

template<class State >
std::vector<hardware_interface::PosVelJointHandle>* HardwareInterfaceAdapter< hardware_interface::PosVelJointInterface, State >::joint_handles_ptr_
private

Definition at line 321 of file hardware_interface_adapter.h.


The documentation for this class was generated from the following file:


joint_trajectory_controller
Author(s): Adolfo Rodriguez Tsouroukdissian
autogenerated on Thu Apr 11 2019 03:08:37