5 #include "pinocchio/multibody/model.hpp" 15 const std::string &
name,
19 typedef typename D::TangentVector_t TV;
20 typedef typename D::ConfigVector_t CV;
22 idx = model.
addJoint(parent_id,jmodel,joint_placement,
25 1e3 * (TV::Random() + TV::Constant(1)),
26 1e3 * (CV::Random() - CV::Constant(1)),
27 1e3 * (CV::Random() + CV::Constant(1))
JointModelPrismaticTpl< double, 0, 0 > JointModelPX
void addJointAndBody(Model &model, const JointModelBase< D > &jmodel, const Model::JointIndex parent_id, const SE3 &joint_placement, const std::string &name, const Inertia &Y)
static InertiaTpl Random()
JointModelRevoluteUnalignedTpl< double > JointModelRevoluteUnaligned
std::string name(const LieGroupGenericTpl< LieGroupCollection > &lg)
Visit a LieGroupVariant to get the name of it.
JointModelSphericalZYXTpl< double > JointModelSphericalZYX
void buildAllJointsModel(Model &model)
JointIndex addJoint(const JointIndex parent, const JointModel &joint_model, const SE3 &joint_placement, const std::string &joint_name)
Add a joint to the kinematic tree with infinite bounds.
pinocchio::JointIndex JointIndex
traits< SE3Tpl >::Vector3 Vector3
JointModelTranslationTpl< double > JointModelTranslation
Main pinocchio namespace.
JointModelSphericalTpl< double > JointModelSpherical
JointIndex getJointId(const std::string &name) const
Return the index of a joint given by its name.
JointModelFreeFlyerTpl< double > JointModelFreeFlyer
JointModelPrismaticUnalignedTpl< double > JointModelPrismaticUnaligned
void appendBodyToJoint(const JointIndex joint_index, const Inertia &Y, const SE3 &body_placement=SE3::Identity())
Append a body to a given joint of the kinematic tree.
JointModelRevoluteTpl< double, 0, 0 > JointModelRX
JointCollectionTpl & model
JointModelPlanarTpl< double > JointModelPlanar