Typedefs | |
typedef boost::shared_ptr < const urdf::Joint > | UrdfJointConstPtr |
Functions | |
std::string | getLeafNamespace (const ros::NodeHandle &nh) |
boost::shared_ptr< urdf::Model > | getUrdf (const ros::NodeHandle &nh, const std::string ¶m_name) |
std::vector< UrdfJointConstPtr > | getUrdfJoints (const urdf::Model &urdf, const std::vector< std::string > &joint_names) |
typedef boost::shared_ptr<const urdf::Joint> gripper_action_controller::internal::UrdfJointConstPtr |
Definition at line 68 of file gripper_action_controller_impl.h.
std::string gripper_action_controller::internal::getLeafNamespace | ( | const ros::NodeHandle & | nh | ) |
Definition at line 37 of file gripper_action_controller_impl.h.
boost::shared_ptr<urdf::Model> 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<UrdfJointConstPtr> gripper_action_controller::internal::getUrdfJoints | ( | const urdf::Model & | urdf, |
const std::vector< std::string > & | joint_names | ||
) |
Definition at line 69 of file gripper_action_controller_impl.h.