1 #ifndef HEBIROS_MODEL_H 2 #define HEBIROS_MODEL_H 13 static bool load(
const std::string& name,
const std::string& description_param);
17 HebirosModel(std::unique_ptr<hebi::robot_model::RobotModel> model_);
25 static std::map<std::string, HebirosModel>
models;
28 std::unique_ptr<hebi::robot_model::RobotModel>
model;
Represents a chain or tree of robot elements (rigid bodies and joints).
HebirosModel(std::unique_ptr< hebi::robot_model::RobotModel > model_)
static std::map< std::string, HebirosModel > models
static bool loadURDF(const std::string &description_param, urdf::Model &model)
hebi::robot_model::RobotModel & getModel()
static bool load(const std::string &name, const std::string &description_param)
std::unique_ptr< hebi::robot_model::RobotModel > model
static std::unique_ptr< hebi::robot_model::RobotModel > parseURDF(const urdf::Model &model)