Public Types | Public Member Functions | Static Public Member Functions | List of all members
pinocchio::python::ContactCholeskyDecompositionPythonVisitor< ContactCholeskyDecomposition > Struct Template Reference

#include <contact-cholesky.hpp>

Inheritance diagram for pinocchio::python::ContactCholeskyDecompositionPythonVisitor< ContactCholeskyDecomposition >:
Inheritance graph
[legend]

Public Types

typedef pinocchio::python::context::Data Data
 
typedef ContactCholeskyDecomposition::Matrix Matrix
 
typedef pinocchio::python::context::Model Model
 
typedef ContactCholeskyDecomposition::RigidConstraintData RigidConstraintData
 
typedef ContactCholeskyDecomposition::RigidConstraintModel RigidConstraintModel
 
typedef ContactCholeskyDecomposition::Scalar Scalar
 
typedef ContactCholeskyDecomposition Self
 
typedef ContactCholeskyDecomposition::Vector Vector
 

Public Member Functions

typedef PINOCCHIO_STD_VECTOR_WITH_EIGEN_ALLOCATOR (RigidConstraintData) RigidConstraintDataVector
 
typedef PINOCCHIO_STD_VECTOR_WITH_EIGEN_ALLOCATOR (RigidConstraintModel) RigidConstraintModelVector
 
template<class PyClass >
void visit (PyClass &cl) const
 

Static Public Member Functions

static void compute (Self &self, const Model &model, Data &data, const RigidConstraintModelVector &contact_models, RigidConstraintDataVector &contact_datas, const Scalar mu=static_cast< Scalar >(0))
 
static void compute (Self &self, const Model &model, Data &data, const RigidConstraintModelVector &contact_models, RigidConstraintDataVector &contact_datas, const Vector &mus)
 
static void expose ()
 
template<typename MatrixType >
static Matrix solve (const Self &self, const MatrixType &mat)
 

Detailed Description

template<typename ContactCholeskyDecomposition>
struct pinocchio::python::ContactCholeskyDecompositionPythonVisitor< ContactCholeskyDecomposition >

Definition at line 28 of file bindings/python/algorithm/contact-cholesky.hpp.

Member Typedef Documentation

◆ Data

◆ Matrix

template<typename ContactCholeskyDecomposition >
typedef ContactCholeskyDecomposition::Matrix pinocchio::python::ContactCholeskyDecompositionPythonVisitor< ContactCholeskyDecomposition >::Matrix

◆ Model

◆ RigidConstraintData

template<typename ContactCholeskyDecomposition >
typedef ContactCholeskyDecomposition::RigidConstraintData pinocchio::python::ContactCholeskyDecompositionPythonVisitor< ContactCholeskyDecomposition >::RigidConstraintData

◆ RigidConstraintModel

template<typename ContactCholeskyDecomposition >
typedef ContactCholeskyDecomposition::RigidConstraintModel pinocchio::python::ContactCholeskyDecompositionPythonVisitor< ContactCholeskyDecomposition >::RigidConstraintModel

◆ Scalar

template<typename ContactCholeskyDecomposition >
typedef ContactCholeskyDecomposition::Scalar pinocchio::python::ContactCholeskyDecompositionPythonVisitor< ContactCholeskyDecomposition >::Scalar

◆ Self

◆ Vector

template<typename ContactCholeskyDecomposition >
typedef ContactCholeskyDecomposition::Vector pinocchio::python::ContactCholeskyDecompositionPythonVisitor< ContactCholeskyDecomposition >::Vector

Member Function Documentation

◆ compute() [1/2]

template<typename ContactCholeskyDecomposition >
static void pinocchio::python::ContactCholeskyDecompositionPythonVisitor< ContactCholeskyDecomposition >::compute ( Self self,
const Model model,
Data data,
const RigidConstraintModelVector &  contact_models,
RigidConstraintDataVector &  contact_datas,
const Scalar  mu = static_cast<Scalar>(0) 
)
inlinestatic

◆ compute() [2/2]

template<typename ContactCholeskyDecomposition >
static void pinocchio::python::ContactCholeskyDecompositionPythonVisitor< ContactCholeskyDecomposition >::compute ( Self self,
const Model model,
Data data,
const RigidConstraintModelVector &  contact_models,
RigidConstraintDataVector &  contact_datas,
const Vector mus 
)
inlinestatic

◆ expose()

template<typename ContactCholeskyDecomposition >
static void pinocchio::python::ContactCholeskyDecompositionPythonVisitor< ContactCholeskyDecomposition >::expose ( )
inlinestatic

◆ PINOCCHIO_STD_VECTOR_WITH_EIGEN_ALLOCATOR() [1/2]

template<typename ContactCholeskyDecomposition >
typedef pinocchio::python::ContactCholeskyDecompositionPythonVisitor< ContactCholeskyDecomposition >::PINOCCHIO_STD_VECTOR_WITH_EIGEN_ALLOCATOR ( RigidConstraintData  )

◆ PINOCCHIO_STD_VECTOR_WITH_EIGEN_ALLOCATOR() [2/2]

template<typename ContactCholeskyDecomposition >
typedef pinocchio::python::ContactCholeskyDecompositionPythonVisitor< ContactCholeskyDecomposition >::PINOCCHIO_STD_VECTOR_WITH_EIGEN_ALLOCATOR ( RigidConstraintModel  )

◆ solve()

template<typename ContactCholeskyDecomposition >
template<typename MatrixType >
static Matrix pinocchio::python::ContactCholeskyDecompositionPythonVisitor< ContactCholeskyDecomposition >::solve ( const Self self,
const MatrixType &  mat 
)
inlinestatic

◆ visit()

template<typename ContactCholeskyDecomposition >
template<class PyClass >
void pinocchio::python::ContactCholeskyDecompositionPythonVisitor< ContactCholeskyDecomposition >::visit ( PyClass &  cl) const
inline

The documentation for this struct was generated from the following file:


pinocchio
Author(s):
autogenerated on Wed Jun 19 2024 02:41:20