#include "pinocchio/multibody/visitor.hpp"
#include "pinocchio/multibody/model.hpp"
#include "pinocchio/multibody/data.hpp"
#include "pinocchio/algorithm/kinematics.hpp"
#include "pinocchio/multibody/geometry.hpp"
#include "pinocchio/algorithm/geometry.hxx"
Go to the source code of this file.
|
void | pinocchio::appendGeometryModel (GeometryModel &geom_model1, const GeometryModel &geom_model2) |
|
template<typename Vector3Like > |
PINOCCHIO_DEPRECATED void | pinocchio::setGeometryMeshScales (GeometryModel &geom_model, const Eigen::MatrixBase< Vector3Like > &meshScale) |
| Set a mesh scaling vector to each GeometryObject contained in the the GeometryModel. More...
|
|
PINOCCHIO_DEPRECATED void | pinocchio::setGeometryMeshScales (GeometryModel &geom_model, const double meshScale) |
| Set an isotropic mesh scaling to each GeometryObject contained in the the GeometryModel. More...
|
|
template<typename Scalar , int Options, template< typename, int > class JointCollectionTpl, typename ConfigVectorType > |
void | pinocchio::updateGeometryPlacements (const ModelTpl< Scalar, Options, JointCollectionTpl > &model, DataTpl< Scalar, Options, JointCollectionTpl > &data, const GeometryModel &geom_model, GeometryData &geom_data, const Eigen::MatrixBase< ConfigVectorType > &q) |
| Apply a forward kinematics and update the placement of the geometry objects. More...
|
|
template<typename Scalar , int Options, template< typename, int > class JointCollectionTpl> |
void | pinocchio::updateGeometryPlacements (const ModelTpl< Scalar, Options, JointCollectionTpl > &model, const DataTpl< Scalar, Options, JointCollectionTpl > &data, const GeometryModel &geom_model, GeometryData &geom_data) |
| Update the placement of the geometry objects according to the current joint placements contained in data. More...
|
|