|  | 
| typedef Base::ADConfigVectorType | ADConfigVectorType | 
|  | 
| typedef Eigen::aligned_allocator< ADContactData > | ADConstraintDataAllocator | 
|  | 
| typedef Eigen::aligned_allocator< ADContactModel > | ADConstraintModelAllocator | 
|  | 
| typedef pinocchio::RigidConstraintDataTpl< ADScalar, Base::Options > | ADContactData | 
|  | 
| typedef std::vector< ADContactData, ADConstraintDataAllocator > | ADContactDataVector | 
|  | 
| typedef pinocchio::RigidConstraintModelTpl< ADScalar, Base::Options > | ADContactModel | 
|  | 
| typedef std::vector< ADContactModel, ADConstraintModelAllocator > | ADContactModelVector | 
|  | 
| typedef Base::ADData | ADData | 
|  | 
| typedef ADData::MatrixXs | ADMatrixXs | 
|  | 
| typedef Base::ADScalar | ADScalar | 
|  | 
| typedef Base::ADTangentVectorType | ADTangentVectorType | 
|  | 
| typedef CodeGenBase< _Scalar > | Base | 
|  | 
| typedef Eigen::aligned_allocator< ContactData > | ConstraintDataAllocator | 
|  | 
| typedef Eigen::aligned_allocator< ContactModel > | ConstraintModelAllocator | 
|  | 
| typedef pinocchio::RigidConstraintDataTpl< Scalar, Base::Options > | ContactData | 
|  | 
| typedef std::vector< ContactData, ConstraintDataAllocator > | ContactDataVector | 
|  | 
| typedef pinocchio::RigidConstraintModelTpl< Scalar, Base::Options > | ContactModel | 
|  | 
| typedef std::vector< ContactModel, ConstraintModelAllocator > | ContactModelVector | 
|  | 
| typedef Base::MatrixXs | MatrixXs | 
|  | 
| typedef Base::Model | Model | 
|  | 
| typedef Base::Scalar | Scalar | 
|  | 
| typedef Base::VectorXs | VectorXs | 
|  | 
| enum | { Options = 0
 } | 
|  | 
| typedef ADModel::ConfigVectorType | ADConfigVectorType | 
|  | 
| typedef pinocchio::DataTpl< ADScalar, Options > | ADData | 
|  | 
| typedef CppAD::ADFun< CGScalar > | ADFun | 
|  | 
| typedef Eigen::Matrix< ADScalar, Eigen::Dynamic, Eigen::Dynamic, Options > | ADMatrixXs | 
|  | 
| typedef pinocchio::ModelTpl< ADScalar, Options > | ADModel | 
|  | 
| typedef CppAD::AD< CGScalar > | ADScalar | 
|  | 
| typedef ADModel::TangentVectorType | ADTangentVectorType | 
|  | 
| typedef Eigen::Matrix< ADScalar, Eigen::Dynamic, 1, Options > | ADVectorXs | 
|  | 
| typedef pinocchio::DataTpl< CGScalar, Options > | CGData | 
|  | 
| typedef pinocchio::ModelTpl< CGScalar, Options > | CGModel | 
|  | 
| typedef CppAD::cg::CG< Scalar > | CGScalar | 
|  | 
| typedef Model::ConfigVectorType | ConfigVectorType | 
|  | 
| typedef pinocchio::DataTpl< Scalar, Options > | Data | 
|  | 
| typedef Eigen::Matrix< Scalar, Eigen::Dynamic, Eigen::Dynamic, Options > | MatrixXs | 
|  | 
| typedef pinocchio::ModelTpl< Scalar, Options > | Model | 
|  | 
| typedef Eigen::Matrix< Scalar, Eigen::Dynamic, Eigen::Dynamic, Options|Eigen::RowMajor > | RowMatrixXs | 
|  | 
| typedef _Scalar | Scalar | 
|  | 
| typedef Model::TangentVectorType | TangentVectorType | 
|  | 
| typedef Eigen::Matrix< Scalar, Eigen::Dynamic, 1, Options > | VectorXs | 
|  | 
|  | 
| void | buildMap () | 
|  | build the mapping Y = f(X)  More... 
 | 
|  | 
|  | CodeGenConstraintDynamicsDerivatives (const Model &model, const ContactModelVector &contact_models, const std::string &function_name="partial_constraintDynamics", const std::string &library_name="cg_partial_constraintDynamics_eval") | 
|  | 
| Eigen::DenseIndex | constraintDim (const ContactModelVector &contact_models) const | 
|  | 
| template<typename ConfigVectorType , typename TangentVector1 , typename TangentVector2 > | 
| void | evalFunction (const Eigen::MatrixBase< ConfigVectorType > &q, const Eigen::MatrixBase< TangentVector1 > &v, const Eigen::MatrixBase< TangentVector2 > &tau) | 
|  | 
| typedef | PINOCCHIO_EIGEN_PLAIN_ROW_MAJOR_TYPE (ADMatrixXs) RowADMatrixXs | 
|  | 
| typedef | PINOCCHIO_EIGEN_PLAIN_ROW_MAJOR_TYPE (MatrixXs) RowMatrixXs | 
|  | 
| virtual | ~CodeGenConstraintDynamicsDerivatives () | 
|  | 
|  | CodeGenBase (const Model &model, const Eigen::DenseIndex dim_input, const Eigen::DenseIndex dim_output, const std::string &function_name, const std::string &library_name) | 
|  | 
| CppAD::cg::ModelCSourceGen< Scalar > & | codeGenerator () | 
|  | 
| void | compileAndLoadLib (const std::string &gcc_path) | 
|  | 
| void | compileLib (const std::string &gcc_path="/usr/bin/gcc", const std::string &compile_options="-Ofast") | 
|  | 
| template<typename Vector > | 
| void | evalFunction (const Eigen::MatrixBase< Vector > &x) | 
|  | 
| template<typename Vector > | 
| void | evalJacobian (const Eigen::MatrixBase< Vector > &x) | 
|  | 
| bool | existLib () const | 
|  | 
| Eigen::DenseIndex | getInputDimension () const | 
|  | Dimension of the input vector.  More... 
 | 
|  | 
| Eigen::DenseIndex | getOutputDimension () const | 
|  | Dimension of the output vector.  More... 
 | 
|  | 
| void | initLib () | 
|  | 
| void | loadLib (const bool generate_if_not_exist=true, const std::string &gcc_path="/usr/bin/gcc", const std::string &compile_options="-Ofast") | 
|  | 
| virtual | ~CodeGenBase () | 
|  | 
template<typename _Scalar>
struct pinocchio::CodeGenConstraintDynamicsDerivatives< _Scalar >
Definition at line 689 of file code-generator-algo.hpp.