38 #include <boost/smart_ptr.hpp> 39 #include <boost/ptr_container/ptr_map.hpp> 40 #include <sr_robot_msgs/joint.h> 70 void sendCommands(std::vector<sr_robot_msgs::joint> joint_vector);
80 std::string get_controller_state_topic(std::string joint_name);
89 std::pair<double, double> get_min_max(std::string joint_name);
97 std::vector<std::string> get_all_joints();
104 std::map<std::string, boost::shared_ptr<urdf::Joint> >
all_joints;
121 void initializeEthercatHand();
bool ethercat_controllers_found
Publisher sr_hand_target_pub
Publisher for the CAN hand targets.
boost::ptr_map< std::string, Publisher > sr_hand_target_pub_map
Publishers for the ethercat hand targets for every joint.
NodeHandle node_
ros node handle
shadowhandRosLib::HandType hand_type
std::map< std::string, boost::shared_ptr< urdf::Joint > > all_joints
stores data about the hand (read from urdf)
static const double TIMEOUT_TO_DETECT_CONTROLLER_MANAGER
std::map< std::string, std::string > sr_hand_sub_topics
A map of topics for the controller states.