Public Member Functions | |
void | read () |
SimpleBot () | |
void | write () |
![]() | |
virtual bool | checkForConflict (const std::list< ControllerInfo > &info) const |
virtual bool | checkForConflict (const std::list< ControllerInfo > &info) const |
virtual void | doSwitch (const std::list< ControllerInfo > &, const std::list< ControllerInfo > &) |
virtual bool | init (ros::NodeHandle &, ros::NodeHandle &) |
virtual bool | prepareSwitch (const std::list< ControllerInfo > &, const std::list< ControllerInfo > &) |
virtual void | read (const ros::Time &, const ros::Duration &) |
virtual void | read (const ros::Time &, const ros::Duration &) |
virtual SwitchState | switchResult (const ControllerInfo &) const |
virtual SwitchState | switchResult () const |
virtual void | write (const ros::Time &, const ros::Duration &) |
virtual void | write (const ros::Time &, const ros::Duration &) |
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) |
Static Public Attributes | |
static constexpr double | period = 0.01 |
Private Attributes | |
double | cmd_ |
double | eff_ |
hardware_interface::EffortJointInterface | effort_interface_ |
double | max_eff_ |
double | pos_ |
hardware_interface::JointStateInterface | state_interface_ |
double | vel_ |
Additional Inherited Members | |
![]() | |
enum | SwitchState |
![]() | |
DONE | |
ERROR | |
ONGOING | |
![]() | |
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 52 of file simple_bot_hw.cpp.
|
inline |
Definition at line 57 of file simple_bot_hw.cpp.
|
inline |
Definition at line 74 of file simple_bot_hw.cpp.
|
inline |
Definition at line 80 of file simple_bot_hw.cpp.
|
private |
Definition at line 92 of file simple_bot_hw.cpp.
|
private |
Definition at line 92 of file simple_bot_hw.cpp.
|
private |
Definition at line 91 of file simple_bot_hw.cpp.
|
private |
Definition at line 93 of file simple_bot_hw.cpp.
|
static |
Definition at line 55 of file simple_bot_hw.cpp.
|
private |
Definition at line 92 of file simple_bot_hw.cpp.
|
private |
Definition at line 90 of file simple_bot_hw.cpp.
|
private |
Definition at line 92 of file simple_bot_hw.cpp.