Public Member Functions | Public Attributes | Private Member Functions | Private Attributes
shadow_robot::TestJointMovement Class Reference

#include <test_joint_movement.hpp>

List of all members.

Public Member Functions

 TestJointMovement (std::string joint_name, shadowrobot::HandCommander *hand_commander)
 ~TestJointMovement ()

Public Attributes

double mse
std::map< std::string,
std::vector< double > > 
values

Private Member Functions

std::string get_ROS_topic_type (std::string topic_name)
void mse_cb_ (const std_msgs::Float64::ConstPtr &msg)
void pr2_state_cb_ (const pr2_controllers_msgs::JointControllerState::ConstPtr &msg)
void state_cb_ (const sr_robot_msgs::JointControllerState::ConstPtr &msg)

Private Attributes

boost::shared_ptr
< shadowrobot::HandCommander
hand_commander_
 used with the sole purpose of knowing the name of the topic we want to subscribe to
std::string joint_name_
ros::Subscriber mse_sub_
boost::shared_ptr
< shadowrobot::MovementFromImage
mvt_from_img_
boost::shared_ptr
< shadowrobot::MovementPublisher
mvt_pub_
ros::NodeHandle nh_tilde_
ros::Subscriber pr2_sub_state_
ros::Publisher pub_
ros::Subscriber sub_
ros::Subscriber sub_state_
boost::shared_ptr< boost::thread > thread_

Detailed Description

Definition at line 40 of file test_joint_movement.hpp.


Constructor & Destructor Documentation

shadow_robot::TestJointMovement::TestJointMovement ( std::string  joint_name,
shadowrobot::HandCommander hand_commander 
)

Definition at line 35 of file test_joint_movement.cpp.

Definition at line 44 of file test_joint_movement.hpp.


Member Function Documentation

std::string shadow_robot::TestJointMovement::get_ROS_topic_type ( std::string  topic_name) [private]

Definition at line 119 of file test_joint_movement.cpp.

void shadow_robot::TestJointMovement::mse_cb_ ( const std_msgs::Float64::ConstPtr &  msg) [private]

Definition at line 110 of file test_joint_movement.cpp.

Definition at line 103 of file test_joint_movement.cpp.

Definition at line 96 of file test_joint_movement.cpp.


Member Data Documentation

used with the sole purpose of knowing the name of the topic we want to subscribe to

Definition at line 72 of file test_joint_movement.hpp.

Definition at line 69 of file test_joint_movement.hpp.

Definition at line 44 of file test_joint_movement.hpp.

Definition at line 58 of file test_joint_movement.hpp.

Definition at line 62 of file test_joint_movement.hpp.

Definition at line 63 of file test_joint_movement.hpp.

Definition at line 65 of file test_joint_movement.hpp.

Definition at line 54 of file test_joint_movement.hpp.

Definition at line 51 of file test_joint_movement.hpp.

Definition at line 50 of file test_joint_movement.hpp.

Definition at line 53 of file test_joint_movement.hpp.

boost::shared_ptr<boost::thread> shadow_robot::TestJointMovement::thread_ [private]

Definition at line 67 of file test_joint_movement.hpp.

std::map<std::string, std::vector<double> > shadow_robot::TestJointMovement::values

Definition at line 47 of file test_joint_movement.hpp.


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


sr_self_test
Author(s): Ugo Cupcic
autogenerated on Mon Oct 6 2014 07:52:52