35 #ifndef URDF_GEOMETRY_PARSER_URDF_GEOMETRY_PARSER_H    36 #define URDF_GEOMETRY_PARSER_URDF_GEOMETRY_PARSER_H    40 #include <urdf/urdfdom_compatibility.h>    41 #include <urdf_parser/urdf_parser.h>    58                           const std::string& parent_link_name,
    59                           urdf::Vector3& transform_vector);
    69                                 const std::string& second_joint_name,
    89                               double& steering_limit);
    93   urdf::ModelInterfaceSharedPtr 
model_;
 
bool getTransformVector(const std::string &joint_name, const std::string &parent_link_name, urdf::Vector3 &transform_vector)
Get transform vector between the joint and parent_link. 
urdf::ModelInterfaceSharedPtr model_
bool getJointSteeringLimits(const std::string &joint_name, double &steering_limit)
Get joint steering limit from the URDF considering the upper and lower limit is the same...
UrdfGeometryParser(ros::NodeHandle &root_nh, const std::string &base_link)
bool getJointRadius(const std::string &joint_name, double &radius)
Get joint radius from the URDF. 
bool getDistanceBetweenJoints(const std::string &first_joint_name, const std::string &second_joint_name, double &distance)
Get distance between two joints from the URDF.