#include <my_robot_hw_2.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 |
Public Member Functions inherited from hardware_interface::RobotHW | |
| virtual bool | checkForConflict (const std::list< ControllerInfo > &info) const |
| virtual bool | checkForConflict (const std::list< ControllerInfo > &info) const |
| virtual SwitchState | switchResult (const ControllerInfo &) const |
| virtual SwitchState | switchResult () const |
| virtual | ~RobotHW ()=default |
Public Member Functions inherited from hardware_interface::InterfaceManager | |
| 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::EffortJointInterface | ej_interface_ |
| std::vector< double > | joint_effort_ |
| std::vector< double > | joint_effort_command_ |
| std::vector< std::string > | joint_name_ |
| std::vector< double > | joint_position_ |
| std::vector< double > | joint_velocity_ |
| std::vector< double > | joint_velocity_command_ |
| hardware_interface::JointStateInterface | js_interface_ |
| hardware_interface::VelocityJointInterface | vj_interface_ |
Additional Inherited Members | |
Public Types inherited from hardware_interface::RobotHW | |
| enum | SwitchState |
Public Attributes inherited from hardware_interface::RobotHW | |
| DONE | |
| ERROR | |
| ONGOING | |
Protected Types inherited from hardware_interface::InterfaceManager | |
| 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 |
Protected Attributes inherited from hardware_interface::InterfaceManager | |
| 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_2.h.
|
overridevirtual |
Reimplemented from hardware_interface::RobotHW.
Definition at line 132 of file my_robot_hw_2.cpp.
|
overridevirtual |
Reimplemented from hardware_interface::RobotHW.
Definition at line 35 of file my_robot_hw_2.cpp.
|
overridevirtual |
Reimplemented from hardware_interface::RobotHW.
Definition at line 82 of file my_robot_hw_2.cpp.
|
overridevirtual |
Reimplemented from hardware_interface::RobotHW.
Definition at line 73 of file my_robot_hw_2.cpp.
|
overridevirtual |
Reimplemented from hardware_interface::RobotHW.
Definition at line 78 of file my_robot_hw_2.cpp.
|
private |
Definition at line 53 of file my_robot_hw_2.h.
|
private |
Definition at line 60 of file my_robot_hw_2.h.
|
private |
Definition at line 56 of file my_robot_hw_2.h.
|
private |
Definition at line 61 of file my_robot_hw_2.h.
|
private |
Definition at line 58 of file my_robot_hw_2.h.
|
private |
Definition at line 59 of file my_robot_hw_2.h.
|
private |
Definition at line 57 of file my_robot_hw_2.h.
|
private |
Definition at line 52 of file my_robot_hw_2.h.
|
private |
Definition at line 54 of file my_robot_hw_2.h.