Classes | |
class | Joint |
Public Member Functions | |
bool | checkNotRunning () const |
bool | checkUnqiue () const |
virtual void | doSwitch (const std::list< hardware_interface::ControllerInfo > &start_list, const std::list< hardware_interface::ControllerInfo > &stop_list) |
virtual bool | prepareSwitch (const std::list< hardware_interface::ControllerInfo > &start_list, const std::list< hardware_interface::ControllerInfo > &stop_list) |
SwitchBot () | |
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 bool | init (ros::NodeHandle &root_nh, ros::NodeHandle &robot_hw_nh) |
virtual void | read (const ros::Time &time, const ros::Duration &period) |
virtual void | read (const ros::Time &time, const ros::Duration &period) |
RobotHW () | |
virtual void | write (const ros::Time &time, const ros::Duration &period) |
virtual void | write (const ros::Time &time, const ros::Duration &period) |
virtual | ~RobotHW () |
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 Types | |
typedef boost::shared_ptr< Joint > | JointSharedPtr |
Private Member Functions | |
JointSharedPtr | makeJoint (const std::string &name) |
Private Attributes | |
hardware_interface::EffortJointInterface | eji_ |
std::map< std::string, JointSharedPtr > | joints_ |
hardware_interface::JointStateInterface | jsi_ |
hardware_interface::PositionJointInterface | pji_ |
std::vector< std::string > | started_ |
std::vector< std::string > | stopped_ |
hardware_interface::VelocityJointInterface | vji_ |
Additional Inherited Members | |
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 | |
boost::ptr_vector< ResourceManagerBase > | interface_destruction_list_ |
InterfaceManagerVector | interface_managers_ |
InterfaceMap | interfaces_ |
InterfaceMap | interfaces_combo_ |
SizeMap | num_ifaces_registered_ |
ResourceMap | resources_ |
Definition at line 65 of file hwi_switch_test.cpp.
|
private |
Definition at line 100 of file hwi_switch_test.cpp.
|
inline |
Definition at line 114 of file hwi_switch_test.cpp.
|
inline |
Definition at line 225 of file hwi_switch_test.cpp.
|
inline |
Definition at line 221 of file hwi_switch_test.cpp.
|
inlinevirtual |
Reimplemented from hardware_interface::RobotHW.
Definition at line 191 of file hwi_switch_test.cpp.
|
inlineprivate |
Definition at line 104 of file hwi_switch_test.cpp.
|
inlinevirtual |
Reimplemented from hardware_interface::RobotHW.
Definition at line 140 of file hwi_switch_test.cpp.
|
private |
Definition at line 70 of file hwi_switch_test.cpp.
|
private |
Definition at line 102 of file hwi_switch_test.cpp.
|
private |
Definition at line 67 of file hwi_switch_test.cpp.
|
private |
Definition at line 68 of file hwi_switch_test.cpp.
|
private |
Definition at line 111 of file hwi_switch_test.cpp.
|
private |
Definition at line 112 of file hwi_switch_test.cpp.
|
private |
Definition at line 69 of file hwi_switch_test.cpp.