Functions | |
std::string | getLeafNamespace (const ros::NodeHandle &nh) |
urdf::ModelSharedPtr | getUrdf (const ros::NodeHandle &nh, const std::string ¶m_name) |
std::vector< urdf::JointConstSharedPtr > | getUrdfJoints (const urdf::Model &urdf, const std::vector< std::string > &joint_names) |
std::string gripper_action_controller::internal::getLeafNamespace | ( | const ros::NodeHandle & | nh | ) |
Definition at line 37 of file gripper_action_controller_impl.h.
urdf::ModelSharedPtr gripper_action_controller::internal::getUrdf | ( | const ros::NodeHandle & | nh, |
const std::string & | param_name | ||
) |
Definition at line 44 of file gripper_action_controller_impl.h.
std::vector<urdf::JointConstSharedPtr> gripper_action_controller::internal::getUrdfJoints | ( | const urdf::Model & | urdf, |
const std::vector< std::string > & | joint_names | ||
) |
Definition at line 68 of file gripper_action_controller_impl.h.