Go to the documentation of this file.
13 #include <boost/test/unit_test.hpp>
15 BOOST_AUTO_TEST_SUITE(BOOST_TEST_MODULE)
22 BOOST_CHECK(
model.nq == 33);
23 BOOST_CHECK(
model.nv == 32);
28 BOOST_CHECK(modelff.
nq == 32);
29 BOOST_CHECK(modelff.
nv == 32);
37 BOOST_CHECK(
model.nq == 6);
38 BOOST_CHECK(
model.nv == 6);
40 #ifdef PINOCCHIO_WITH_HPP_FCL
43 pinocchio::buildModels::manipulatorGeometries(
model, geom);
53 BOOST_CHECK(
model.nq == 35);
54 BOOST_CHECK(
model.nv == 34);
56 #ifdef PINOCCHIO_WITH_HPP_FCL
58 pinocchio::buildModels::humanoidGeometries(
model, geom);
70 BOOST_AUTO_TEST_SUITE_END()
void forwardKinematics(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, DataTpl< Scalar, Options, JointCollectionTpl > &data, const Eigen::MatrixBase< ConfigVectorType > &q)
Update the joint placements according to the current joint configuration.
void updateGeometryPlacements(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, DataTpl< Scalar, Options, JointCollectionTpl > &data, const GeometryModel &geom_model, GeometryData &geom_data, const Eigen::MatrixBase< ConfigVectorType > &q)
Apply a forward kinematics and update the placement of the geometry objects.
void humanoidRandom(ModelTpl< Scalar, Options, JointCollectionTpl > &model, bool usingFF=true)
Create a humanoid kinematic tree with 6-DOF limbs and random joint placements.
void manipulator(ModelTpl< Scalar, Options, JointCollectionTpl > &model)
Create a 6-DOF kinematic chain shoulder-elbow-wrist.
void humanoid(ModelTpl< Scalar, Options, JointCollectionTpl > &model, bool usingFF=true)
Create a 28-DOF kinematic chain of a floating humanoid robot.
int nv
Dimension of the velocity vector space.
BOOST_AUTO_TEST_CASE(build_model_sample_humanoid_random)
void neutral(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, const Eigen::MatrixBase< ReturnType > &qout)
Return the neutral configuration element related to the model configuration space.
int nq
Dimension of the configuration vector representation.
pinocchio
Author(s):
autogenerated on Fri Nov 1 2024 02:41:48