Public Member Functions | |
void | check_hw_actuator (std::string name, int motor_id, int id_in_enum, double expected_pos) |
HandLibTest () | |
~HandLibTest () | |
Public Attributes | |
sr_actuator::SrMotorActuator * | actuator |
ros_ethercat_model::RobotState * | hw = NULL |
XmlRpc::XmlRpcValue | joint_to_sensor_mapping |
boost::shared_ptr < HandLibTestProtected > | sr_hand_lib |
Private Attributes | |
ros::NodeHandle | nh |
Definition at line 53 of file test_robot_lib.cpp.
HandLibTest::HandLibTest | ( | ) | [inline] |
Definition at line 62 of file test_robot_lib.cpp.
HandLibTest::~HandLibTest | ( | ) | [inline] |
Definition at line 86 of file test_robot_lib.cpp.
void HandLibTest::check_hw_actuator | ( | std::string | name, |
int | motor_id, | ||
int | id_in_enum, | ||
double | expected_pos | ||
) | [inline] |
Definition at line 91 of file test_robot_lib.cpp.
sr_actuator::SrMotorActuator* HandLibTest::actuator |
Definition at line 59 of file test_robot_lib.cpp.
ros_ethercat_model::RobotState* HandLibTest::hw = NULL |
Definition at line 57 of file test_robot_lib.cpp.
Definition at line 60 of file test_robot_lib.cpp.
ros::NodeHandle HandLibTest::nh [private] |
Definition at line 55 of file test_robot_lib.cpp.
boost::shared_ptr<HandLibTestProtected> HandLibTest::sr_hand_lib |
Definition at line 58 of file test_robot_lib.cpp.