tests/robot-wrapper.cpp
Go to the documentation of this file.
1 //
2 // Copyright (c) 2017 CNRS
3 //
4 // This file is part of tsid
5 // tsid is free software: you can redistribute it
6 // and/or modify it under the terms of the GNU Lesser General Public
7 // License as published by the Free Software Foundation, either version
8 // 3 of the License, or (at your option) any later version.
9 // tsid is distributed in the hope that it will be
10 // useful, but WITHOUT ANY WARRANTY; without even the implied warranty
11 // of MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE. See the GNU
12 // General Lesser Public License for more details. You should have
13 // received a copy of the GNU Lesser General Public License along with
14 // tsid If not, see
15 // <http://www.gnu.org/licenses/>.
16 //
17 
18 #include <iostream>
19 
20 #include <boost/test/unit_test.hpp>
21 #include <boost/utility/binary.hpp>
22 
24 #include <pinocchio/algorithm/joint-configuration.hpp>
25 
26 using namespace tsid;
27 using namespace tsid::math;
28 using namespace tsid::robots;
29 
30 BOOST_AUTO_TEST_SUITE(BOOST_TEST_MODULE)
31 
32 BOOST_AUTO_TEST_CASE(test_robot_wrapper) {
33  using namespace std;
34  using namespace pinocchio;
35 
36  const string romeo_model_path = TSID_SOURCE_DIR "/models/romeo";
37 
38  vector<string> package_dirs;
39  package_dirs.push_back(romeo_model_path);
40  string urdfFileName = package_dirs[0] + "/urdf/romeo.urdf";
41 
42  RobotWrapper robot(urdfFileName, package_dirs,
44 
45  const Model& model = robot.model();
46 
47  // Update default config bounds to take into account the Free Flyer
49  lb.head<3>().fill(-10.);
50  lb.segment<4>(3).fill(-1.);
51 
53  ub.head<3>().fill(10.);
54  ub.segment<4>(3).fill(1.);
55 
56  Vector q = pinocchio::randomConfiguration(model, lb, ub);
57  Vector v = Vector::Ones(robot.nv());
58  Data data(robot.model());
59  robot.computeAllTerms(data, q, v);
60 
61  Vector3 com = robot.com(data);
62  std::cout << com << std::endl;
63  BOOST_CHECK(robot.nq() == 38);
64  BOOST_CHECK(robot.nv() == 37);
65 }
66 
67 BOOST_AUTO_TEST_SUITE_END()
Eigen::Matrix< Scalar, Eigen::Dynamic, 1 > Vector
Definition: math/fwd.hpp:35
ConfigVectorType lowerPositionLimit
const Model & model() const
Accessor to model.
const string romeo_model_path
Definition: contacts.cpp:39
data
Definition: setup.in.py:48
fill
Eigen::Matrix< Scalar, 3, 1 > Vector3
Definition: math/fwd.hpp:40
com
void randomConfiguration(const LieGroupGenericTpl< LieGroupCollection > &lg, const Eigen::MatrixBase< ConfigL_t > &q0, const Eigen::MatrixBase< ConfigR_t > &q1, const Eigen::MatrixBase< ConfigOut_t > &qout)
void com(const Data &data, RefVector com_pos, RefVector com_vel, RefVector com_acc) const
BOOST_AUTO_TEST_CASE(test_robot_wrapper)
Wrapper for a robot based on pinocchio.
package_dirs
void computeAllTerms(Data &data, const Vector &q, const Vector &v) const
ConfigVectorType upperPositionLimit


tsid
Author(s): Andrea Del Prete, Justin Carpentier
autogenerated on Sun Jul 2 2023 02:21:51