copy.cpp
Go to the documentation of this file.
1 //
2 // Copyright(c) 2018-2020 CNRS INRIA
3 //
4 
5 #include "pinocchio/algorithm/copy.hpp"
6 #include "pinocchio/algorithm/kinematics.hpp"
7 #include "pinocchio/algorithm/rnea.hpp"
8 #include "pinocchio/algorithm/joint-configuration.hpp"
9 #include "pinocchio/parsers/sample-models.hpp"
10 
11 #include <boost/test/unit_test.hpp>
12 #include <boost/utility/binary.hpp>
13 
14 BOOST_AUTO_TEST_SUITE(BOOST_TEST_MODULE)
15 
16 BOOST_AUTO_TEST_CASE(test_data_copy)
17 {
18  using namespace Eigen;
19  using namespace pinocchio;
20 
21  Model model;
23 
24  model.upperPositionLimit.head<3>().fill(100);
25  model.upperPositionLimit.segment<4>(3).setOnes();
26  model.lowerPositionLimit.head<7>() = - model.upperPositionLimit.head<7>();
27 
28  VectorXd q(model.nq);
29  q = randomConfiguration(model);
30  VectorXd v(VectorXd::Random(model.nv));
31  VectorXd a(VectorXd::Random(model.nv));
32 
33  Data data_ref(model), data(model);
34  forwardKinematics(model,data_ref,q,v,a);
35  rnea(model,data_ref,q,v,a); // for a_gf to be initialized
36 
37  // Check zero order kinematic quantities
38  copy(model,data_ref,data,POSITION);
39  for(Model::JointIndex i = 1; i < (Model::JointIndex)model.njoints; ++i)
40  {
41  BOOST_CHECK(data.oMi[i] == data_ref.oMi[i]);
42  }
43 
44  // Check first order kinematic quantities
45  copy(model,data_ref,data,VELOCITY);
46  for(Model::JointIndex i = 1; i < (Model::JointIndex)model.njoints; ++i)
47  {
48  BOOST_CHECK(data.oMi[i] == data_ref.oMi[i]);
49  BOOST_CHECK(data.v[i] == data_ref.v[i]);
50  }
51 
52  // Check second order kinematic quantities
53  copy(model,data_ref,data,ACCELERATION);
54  for(Model::JointIndex i = 1; i < (Model::JointIndex)model.njoints; ++i)
55  {
56  BOOST_CHECK(data.oMi[i] == data_ref.oMi[i]);
57  BOOST_CHECK(data.v[i] == data_ref.v[i]);
58  BOOST_CHECK(data.a[i] == data_ref.a[i]);
59  BOOST_CHECK(data.a_gf[i] == data_ref.a_gf[i]);
60  }
61 
62 }
63 
64 BOOST_AUTO_TEST_SUITE_END()
Refers to the quantities related to the 2nd-order kinematics (joint accelerations, center of mass acceleration, etc.).
BOOST_AUTO_TEST_CASE(test_data_copy)
Definition: copy.cpp:16
q
void rnea(const int num_threads, ModelPoolTpl< Scalar, Options, JointCollectionTpl > &pool, const Eigen::MatrixBase< ConfigVectorPool > &q, const Eigen::MatrixBase< TangentVectorPool1 > &v, const Eigen::MatrixBase< TangentVectorPool2 > &a, const Eigen::MatrixBase< TangentVectorPool3 > &tau)
The Recursive Newton-Euler algorithm. It computes the inverse dynamics, aka the joint torques accordi...
int njoints
Number of joints.
ConfigVectorType lowerPositionLimit
Lower joint configuration limit.
v
void randomConfiguration(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, const Eigen::MatrixBase< ConfigVectorIn1 > &lowerLimits, const Eigen::MatrixBase< ConfigVectorIn2 > &upperLimits, const Eigen::MatrixBase< ReturnType > &qout)
Generate a configuration vector uniformly sampled among provided limits.
data
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.
pinocchio::JointIndex JointIndex
Refers to the quantities related to the 1st-order kinematics (joint velocities, center of mass veloci...
Main pinocchio namespace.
Definition: timings.cpp:30
int nv
Dimension of the velocity vector space.
list a
void setOnes(Eigen::Ref< MatType > mat)
void copy(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, const DataTpl< Scalar, Options, JointCollectionTpl > &origin, DataTpl< Scalar, Options, JointCollectionTpl > &dest, KinematicLevel kinematic_level)
Copy part of the data from origin to dest. Template parameter can be used to select at which differen...
Definition: copy.hpp:52
ConfigVectorType upperPositionLimit
Upper joint configuration limit.
void humanoidRandom(ModelTpl< Scalar, Options, JointCollectionTpl > &model, bool usingFF=true)
Create a humanoid kinematic tree with 6-DOF limbs and random joint placements.
Eigen::Matrix< Scalar, Eigen::Dynamic, 1 > VectorXd
Definition: conversions.cpp:14
int nq
Dimension of the configuration vector representation.
Refers to the quantities related to the 0-order kinematics (joint placements, center of mass position...
void fill(Eigen::Ref< MatType > mat, const typename MatType::Scalar &value)


pinocchio
Author(s):
autogenerated on Tue Jun 1 2021 02:45:02