#include <iostream>
#include <cstdio>
#include "pinocchio/multibody/model.hpp"
#include "pinocchio/parsers/mjcf.hpp"
#include "pinocchio/parsers/urdf.hpp"
#include "pinocchio/algorithm/joint-configuration.hpp"
#include "pinocchio/algorithm/frames.hpp"
#include "pinocchio/multibody/joint/joints.hpp"
#include <boost/test/unit_test.hpp>
#include <boost/filesystem/fstream.hpp>
Go to the source code of this file.
Functions | |
BOOST_AUTO_TEST_CASE (adding_keyframes) | |
BOOST_AUTO_TEST_CASE (adding_site) | |
BOOST_AUTO_TEST_CASE (build_model_no_root_joint) | |
test that a fixed model is well parsed More... | |
BOOST_AUTO_TEST_CASE (build_model_with_root_joint_name) | |
BOOST_AUTO_TEST_CASE (convert_inertia_diaginertia) | |
BOOST_AUTO_TEST_CASE (convert_inertia_fullinertia) | |
BOOST_AUTO_TEST_CASE (convert_orientation) | |
BOOST_AUTO_TEST_CASE (geoms_construction) | |
Test for geometry computing. More... | |
BOOST_AUTO_TEST_CASE (inertia_from_geom) | |
Test for computing inertia from geoms. More... | |
BOOST_AUTO_TEST_CASE (joint_and_inertias) | |
BOOST_AUTO_TEST_CASE (keyframe_and_composite) | |
BOOST_AUTO_TEST_CASE (merge_default) | |
Test if merging default classes works. More... | |
BOOST_AUTO_TEST_CASE (parse_composite_Mujoco_comparison) | |
BOOST_AUTO_TEST_CASE (parse_composite_PXPY) | |
BOOST_AUTO_TEST_CASE (parse_composite_PXRY) | |
BOOST_AUTO_TEST_CASE (parse_composite_PXSphere) | |
BOOST_AUTO_TEST_CASE (parse_composite_RXRY) | |
BOOST_AUTO_TEST_CASE (parse_dirs_no_strippath) | |
Test to see if path options work. More... | |
BOOST_AUTO_TEST_CASE (parse_dirs_strippath) | |
Test strippath option. More... | |
BOOST_AUTO_TEST_CASE (parse_Free) | |
BOOST_AUTO_TEST_CASE (parse_PX) | |
BOOST_AUTO_TEST_CASE (parse_RX) | |
BOOST_AUTO_TEST_CASE (parse_Sphere) | |
BOOST_AUTO_TEST_CASE (reference_positions) | |
BOOST_AUTO_TEST_CASE (test_contact_parsing) | |
static bool | comparePropertyTrees (const boost::property_tree::ptree &pt1, const boost::property_tree::ptree &pt2) |
static TemporaryFileHolder | createTempFile (const std::istringstream &data) |
BOOST_AUTO_TEST_CASE | ( | build_model_no_root_joint | ) |
BOOST_AUTO_TEST_CASE | ( | geoms_construction | ) |
BOOST_AUTO_TEST_CASE | ( | inertia_from_geom | ) |
BOOST_AUTO_TEST_CASE | ( | merge_default | ) |
BOOST_AUTO_TEST_CASE | ( | parse_dirs_no_strippath | ) |
BOOST_AUTO_TEST_CASE | ( | parse_dirs_strippath | ) |
|
static |