20 #include <boost/test/unit_test.hpp> 21 #include <boost/utility/binary.hpp> 23 #include <pinocchio/algorithm/joint-configuration.hpp> 35 BOOST_AUTO_TEST_SUITE(BOOST_TEST_MODULE)
37 #define REQUIRE_FINITE(A) BOOST_REQUIRE_MESSAGE(isFinite(A), #A << ": " << A) 42 const double lx = 0.07;
43 const double ly = 0.12;
44 const double lz = 0.105;
45 const double mu = 0.3;
46 const double fMin = 10.0;
47 const double fMax = 1000.0;
48 const std::string
frameName =
"r_sole_joint";
51 package_dirs.push_back(romeo_model_path);
52 string urdfFileName = package_dirs[0] +
"/urdf/romeo.urdf";
60 contactPoints << -
lx, -
lx, +
lx, +
lx, -
ly, +
ly, -
ly, +
ly,
lz,
lz,
lz,
lz;
61 Contact6d
contact(
"contact6d", robot, frameName, contactPoints, contactNormal,
64 BOOST_CHECK(contact.n_motion() == 6);
65 BOOST_CHECK(contact.n_force() == 12);
71 BOOST_CHECK(contact.Kp().isApprox(Kp));
72 BOOST_CHECK(contact.Kd().isApprox(Kd));
81 contact.setReference(H_ref);
84 contact.computeMotionTask(t, q, v,
data);
87 contact.computeForceTask(t, q, v,
data);
90 f3 << 0.0, 0.0, 100.0;
92 BOOST_CHECK(forceIneq.checkConstraint(f));
94 ((forceIneq.matrix() *
f).array() <= forceIneq.upperBound().array())
97 ((forceIneq.matrix() *
f).array() >= forceIneq.lowerBound().array())
99 f(0) =
f(2) * mu * 1.1;
100 BOOST_CHECK(forceIneq.checkConstraint(f) ==
false);
103 BOOST_CHECK(forceGenMat.rows() == 6 && forceGenMat.cols() == 12);
105 contact.computeForceRegularizationTask(t, q, v,
data);
108 BOOST_AUTO_TEST_SUITE_END()
Eigen::Matrix< Scalar, Eigen::Dynamic, Eigen::Dynamic > Matrix
bool existFrame(const std::string &name, const FrameType &type=(FrameType)(JOINT|FIXED_JOINT|BODY|OP_FRAME|SENSOR)) const
Eigen::Matrix< Scalar, Eigen::Dynamic, 1 > Vector
const Model & model() const
Accessor to model.
Eigen::Matrix< Scalar, 3, 1 > Vector3
FrameIndex getFrameId(const std::string &name, const FrameType &type=(FrameType)(JOINT|FIXED_JOINT|BODY|OP_FRAME|SENSOR)) const
Eigen::Matrix< Scalar, 3, Eigen::Dynamic > Matrix3x
Wrapper for a robot based on pinocchio.
void neutral(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, const Eigen::MatrixBase< ReturnType > &qout)
const SE3 & position(const Data &data, const Model::JointIndex index) const
void computeAllTerms(Data &data, const Vector &q, const Vector &v) const