37 #ifndef URDF__MODEL_H_ 38 #define URDF__MODEL_H_ 42 #include <urdf_model/model.h> 43 #include <urdf/urdfdom_compatibility.h> 45 #include <boost/shared_ptr.hpp> 46 #include <boost/weak_ptr.hpp> 54 class Model :
public ModelInterface
77 #endif // URDF__MODEL_H_ URDF_EXPORT bool initFile(const std::string &filename)
Load Model given a filename.
bool param(const std::string ¶m_name, T ¶m_val, const T &default_val)
URDF_EXPORT bool initString(const std::string &xmlstring)
Load Model from a XML-string.
URDF_EXPORT bool initXml(TiXmlElement *xml)
Load Model from TiXMLElement.
URDF_EXPORT bool initParamWithNodeHandle(const std::string ¶m, const ros::NodeHandle &nh=ros::NodeHandle())
Load Model given the name of parameter on parameter server using provided nodehandle.
URDF_EXPORT bool initParam(const std::string ¶m)
Load Model given the name of a parameter on the parameter server.