#include "pinocchio/spatial/fwd.hpp"
#include "pinocchio/spatial/skew.hpp"
#include "pinocchio/utils/timer.hpp"
#include <boost/random.hpp>
#include <Eigen/Geometry>
#include "pinocchio/spatial/symmetric3.hpp"
#include <boost/test/unit_test.hpp>
#include <boost/utility/binary.hpp>
Go to the source code of this file.
Functions | |
BOOST_AUTO_TEST_CASE (cast) | |
BOOST_AUTO_TEST_CASE (comparison) | |
BOOST_AUTO_TEST_CASE (test_eigen_SelfAdj) | |
BOOST_AUTO_TEST_CASE (test_pinocchio_Sym3) | |
void | timeSelfAdj (const Eigen::Matrix3d &A, const Eigen::Matrix3d &Sdense, Eigen::Matrix3d &ASA) |
void | timeSym3 (const pinocchio::Symmetric3 &S, const pinocchio::Symmetric3::Matrix3 &R, pinocchio::Symmetric3 &res) |
BOOST_AUTO_TEST_CASE | ( | cast | ) |
Definition at line 341 of file symmetric.cpp.
BOOST_AUTO_TEST_CASE | ( | comparison | ) |
Definition at line 329 of file symmetric.cpp.
BOOST_AUTO_TEST_CASE | ( | test_eigen_SelfAdj | ) |
Definition at line 287 of file symmetric.cpp.
BOOST_AUTO_TEST_CASE | ( | test_pinocchio_Sym3 | ) |
Definition at line 70 of file symmetric.cpp.
void timeSelfAdj | ( | const Eigen::Matrix3d & | A, |
const Eigen::Matrix3d & | Sdense, | ||
Eigen::Matrix3d & | ASA | ||
) |
Definition at line 58 of file symmetric.cpp.
void timeSym3 | ( | const pinocchio::Symmetric3 & | S, |
const pinocchio::Symmetric3::Matrix3 & | R, | ||
pinocchio::Symmetric3 & | res | ||
) |
Definition at line 32 of file symmetric.cpp.