Public Member Functions | Private Attributes | List of all members
combined_robot_hw_tests::MyRobotHW4 Class Reference

#include <my_robot_hw_4.h>

Inheritance diagram for combined_robot_hw_tests::MyRobotHW4:
Inheritance graph
[legend]

Public Member Functions

virtual void doSwitch (const std::list< hardware_interface::ControllerInfo > &start_list, const std::list< hardware_interface::ControllerInfo > &stop_list)
 
virtual bool init (ros::NodeHandle &root_nh, ros::NodeHandle &robot_hw_nh)
 
 MyRobotHW4 ()
 
virtual bool prepareSwitch (const std::list< hardware_interface::ControllerInfo > &start_list, const std::list< hardware_interface::ControllerInfo > &stop_list)
 
void read (const ros::Time &time, const ros::Duration &period)
 
void write (const ros::Time &time, const ros::Duration &period)
 
virtual ~MyRobotHW4 ()
 
- 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
 
 RobotHW ()
 
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 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

- 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< ResourceManagerBaseinterface_destruction_list_
 
InterfaceManagerVector interface_managers_
 
InterfaceMap interfaces_
 
InterfaceMap interfaces_combo_
 
SizeMap num_ifaces_registered_
 
ResourceMap resources_
 

Detailed Description

Definition at line 40 of file my_robot_hw_4.h.

Constructor & Destructor Documentation

combined_robot_hw_tests::MyRobotHW4::MyRobotHW4 ( )

Definition at line 34 of file my_robot_hw_4.cpp.

virtual combined_robot_hw_tests::MyRobotHW4::~MyRobotHW4 ( )
inlinevirtual

Definition at line 44 of file my_robot_hw_4.h.

Member Function Documentation

void combined_robot_hw_tests::MyRobotHW4::doSwitch ( const std::list< hardware_interface::ControllerInfo > &  start_list,
const std::list< hardware_interface::ControllerInfo > &  stop_list 
)
virtual

Reimplemented from hardware_interface::RobotHW.

Definition at line 90 of file my_robot_hw_4.cpp.

bool combined_robot_hw_tests::MyRobotHW4::init ( ros::NodeHandle root_nh,
ros::NodeHandle robot_hw_nh 
)
virtual

Reimplemented from hardware_interface::RobotHW.

Definition at line 38 of file my_robot_hw_4.cpp.

bool combined_robot_hw_tests::MyRobotHW4::prepareSwitch ( const std::list< hardware_interface::ControllerInfo > &  start_list,
const std::list< hardware_interface::ControllerInfo > &  stop_list 
)
virtual

Reimplemented from hardware_interface::RobotHW.

Definition at line 69 of file my_robot_hw_4.cpp.

void combined_robot_hw_tests::MyRobotHW4::read ( const ros::Time time,
const ros::Duration period 
)
virtual

Reimplemented from hardware_interface::RobotHW.

Definition at line 60 of file my_robot_hw_4.cpp.

void combined_robot_hw_tests::MyRobotHW4::write ( const ros::Time time,
const ros::Duration period 
)
virtual

Reimplemented from hardware_interface::RobotHW.

Definition at line 65 of file my_robot_hw_4.cpp.

Member Data Documentation

hardware_interface::HardwareInterface combined_robot_hw_tests::MyRobotHW4::a_plain_hw_interface_
private

Definition at line 57 of file my_robot_hw_4.h.

double combined_robot_hw_tests::MyRobotHW4::force_[3]
private

Definition at line 59 of file my_robot_hw_4.h.

std::string combined_robot_hw_tests::MyRobotHW4::frame_id_
private

Definition at line 62 of file my_robot_hw_4.h.

hardware_interface::ForceTorqueSensorInterface combined_robot_hw_tests::MyRobotHW4::ft_sensor_interface_
private

Definition at line 56 of file my_robot_hw_4.h.

std::string combined_robot_hw_tests::MyRobotHW4::sensor_name_
private

Definition at line 61 of file my_robot_hw_4.h.

double combined_robot_hw_tests::MyRobotHW4::torque_[3]
private

Definition at line 60 of file my_robot_hw_4.h.


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


combined_robot_hw_tests
Author(s): Toni Oliver
autogenerated on Mon Apr 20 2020 03:52:11