#include <my_robot_hw_4.h>
Public Member Functions | |
void | doSwitch (const std::list< hardware_interface::ControllerInfo > &start_list, const std::list< hardware_interface::ControllerInfo > &stop_list) override |
bool | init (ros::NodeHandle &root_nh, ros::NodeHandle &robot_hw_nh) override |
bool | prepareSwitch (const std::list< hardware_interface::ControllerInfo > &start_list, const std::list< hardware_interface::ControllerInfo > &stop_list) override |
void | read (const ros::Time &time, const ros::Duration &period) override |
void | write (const ros::Time &time, const ros::Duration &period) override |
![]() | |
virtual bool | checkForConflict (const std::list< ControllerInfo > &info) const |
virtual bool | checkForConflict (const std::list< ControllerInfo > &info) const |
virtual SwitchState | switchResult () const |
virtual SwitchState | switchResult (const ControllerInfo &) const |
virtual | ~RobotHW ()=default |
![]() | |
T * | get () |
std::vector< std::string > | getInterfaceResources (std::string iface_type) const |
std::vector< std::string > | getNames () const |
void | registerInterface (T *iface) |
void | registerInterfaceManager (InterfaceManager *iface_man) |
Private Attributes | |
hardware_interface::HardwareInterface | a_plain_hw_interface_ |
double | force_ [3] |
std::string | frame_id_ |
hardware_interface::ForceTorqueSensorInterface | ft_sensor_interface_ |
std::string | sensor_name_ |
double | torque_ [3] |
Additional Inherited Members | |
![]() | |
enum | SwitchState { SwitchState::DONE, SwitchState::ONGOING, SwitchState::ERROR } |
![]() | |
typedef std::vector< InterfaceManager * > | InterfaceManagerVector |
typedef std::map< std::string, void * > | InterfaceMap |
typedef std::map< std::string, std::vector< std::string > > | ResourceMap |
typedef std::map< std::string, size_t > | SizeMap |
![]() | |
std::vector< ResourceManagerBase * > | interface_destruction_list_ |
InterfaceManagerVector | interface_managers_ |
InterfaceMap | interfaces_ |
InterfaceMap | interfaces_combo_ |
SizeMap | num_ifaces_registered_ |
ResourceMap | resources_ |
Definition at line 38 of file my_robot_hw_4.h.
|
overridevirtual |
Reimplemented from hardware_interface::RobotHW.
Definition at line 86 of file my_robot_hw_4.cpp.
|
overridevirtual |
Reimplemented from hardware_interface::RobotHW.
Definition at line 34 of file my_robot_hw_4.cpp.
|
overridevirtual |
Reimplemented from hardware_interface::RobotHW.
Definition at line 65 of file my_robot_hw_4.cpp.
|
overridevirtual |
Reimplemented from hardware_interface::RobotHW.
Definition at line 56 of file my_robot_hw_4.cpp.
|
overridevirtual |
Reimplemented from hardware_interface::RobotHW.
Definition at line 61 of file my_robot_hw_4.cpp.
|
private |
Definition at line 53 of file my_robot_hw_4.h.
|
private |
Definition at line 55 of file my_robot_hw_4.h.
|
private |
Definition at line 58 of file my_robot_hw_4.h.
|
private |
Definition at line 52 of file my_robot_hw_4.h.
|
private |
Definition at line 57 of file my_robot_hw_4.h.
|
private |
Definition at line 56 of file my_robot_hw_4.h.