Public Member Functions | Private Attributes | List of all members
controller_manager_tests::MyRobotHW Class Reference

#include <my_robot_hw.h>

Inheritance diagram for controller_manager_tests::MyRobotHW:
Inheritance graph
[legend]

Public Member Functions

 MyRobotHW ()
 
void read ()
 
void write ()
 
- 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 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
 
virtual SwitchState switchResult (const ControllerInfo &) const
 
virtual void write (const ros::Time &, const ros::Duration &)
 
virtual void write (const ros::Time &, const ros::Duration &)
 
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 { SwitchState::DONE, SwitchState::ONGOING, SwitchState::ERROR }
 
- 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_
 

Detailed Description

Definition at line 41 of file my_robot_hw.h.

Constructor & Destructor Documentation

◆ MyRobotHW()

controller_manager_tests::MyRobotHW::MyRobotHW ( )

Definition at line 38 of file my_robot_hw.cpp.

Member Function Documentation

◆ read()

void controller_manager_tests::MyRobotHW::read ( )

Definition at line 90 of file my_robot_hw.cpp.

◆ write()

void controller_manager_tests::MyRobotHW::write ( )

Definition at line 95 of file my_robot_hw.cpp.

Member Data Documentation

◆ ej_interface_

hardware_interface::EffortJointInterface controller_manager_tests::MyRobotHW::ej_interface_
private

Definition at line 53 of file my_robot_hw.h.

◆ joint_effort_

std::vector<double> controller_manager_tests::MyRobotHW::joint_effort_
private

Definition at line 60 of file my_robot_hw.h.

◆ joint_effort_command_

std::vector<double> controller_manager_tests::MyRobotHW::joint_effort_command_
private

Definition at line 56 of file my_robot_hw.h.

◆ joint_name_

std::vector<std::string> controller_manager_tests::MyRobotHW::joint_name_
private

Definition at line 61 of file my_robot_hw.h.

◆ joint_position_

std::vector<double> controller_manager_tests::MyRobotHW::joint_position_
private

Definition at line 58 of file my_robot_hw.h.

◆ joint_velocity_

std::vector<double> controller_manager_tests::MyRobotHW::joint_velocity_
private

Definition at line 59 of file my_robot_hw.h.

◆ joint_velocity_command_

std::vector<double> controller_manager_tests::MyRobotHW::joint_velocity_command_
private

Definition at line 57 of file my_robot_hw.h.

◆ js_interface_

hardware_interface::JointStateInterface controller_manager_tests::MyRobotHW::js_interface_
private

Definition at line 52 of file my_robot_hw.h.

◆ vj_interface_

hardware_interface::VelocityJointInterface controller_manager_tests::MyRobotHW::vj_interface_
private

Definition at line 54 of file my_robot_hw.h.


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


controller_manager_tests
Author(s): Vijay Pradeep, Adolfo Rodriguez Tsouroukdissian
autogenerated on Tue Oct 15 2024 02:08:24