20 #include <boost/test/unit_test.hpp> 21 #include <boost/utility/binary.hpp> 27 BOOST_AUTO_TEST_SUITE(BOOST_TEST_MODULE)
34 using namespace Eigen;
42 TrajectoryBase *
traj =
new TrajectorySE3Constant(
"traj_se3", M_ref);
43 BOOST_CHECK(traj->has_trajectory_ended());
44 BOOST_CHECK(traj->computeNext().getValue().isApprox(M_vec));
45 BOOST_CHECK(traj->operator()(0.0).getValue().isApprox(M_vec));
48 traj->getLastSample(sample);
49 BOOST_CHECK(sample.getValue().isApprox(M_vec));
50 BOOST_CHECK(sample.getDerivative().isApprox(zero));
51 BOOST_CHECK(sample.getSecondDerivative().isApprox(zero));
58 using namespace Eigen;
60 const unsigned int n = 5;
63 TrajectoryBase *
traj =
new TrajectoryEuclidianConstant(
"traj_eucl", q_ref);
65 BOOST_CHECK(traj->has_trajectory_ended());
66 BOOST_CHECK(traj->computeNext().getValue().isApprox(q_ref));
67 BOOST_CHECK(traj->operator()(0.0).getValue().isApprox(q_ref));
70 traj->getLastSample(sample);
71 BOOST_CHECK(sample.getValue().isApprox(q_ref));
72 BOOST_CHECK(sample.getDerivative().isApprox(zero));
73 BOOST_CHECK(sample.getSecondDerivative().isApprox(zero));
76 BOOST_AUTO_TEST_SUITE_END()
void SE3ToVector(const pinocchio::SE3 &M, RefVector vec)
trajectories::TrajectorySample TrajectorySample
BOOST_AUTO_TEST_CASE(test_trajectory_se3)
Eigen::Matrix< Scalar, Eigen::Dynamic, 1 > VectorXd