Namespaces | Classes | Enumerations | Functions
eigenpy Namespace Reference

Namespaces

 details
 
 internal
 

Classes

class  AngleAxisVisitor
 
struct  BFGSPreconditionerBaseVisitor
 
struct  call
 Allows a template specialization. More...
 
struct  call< Eigen::AngleAxis< Scalar > >
 
struct  call< Eigen::Quaternion< Scalar, Options > >
 
struct  ConjugateGradientVisitor
 
struct  DiagonalPreconditionerVisitor
 
struct  EigenAllocator
 
struct  EigenFromPy
 
struct  EigenFromPy< Eigen::EigenBase< MatType >, typename MatType::Scalar >
 
struct  EigenFromPy< Eigen::MatrixBase< MatType > >
 
struct  EigenFromPy< Eigen::PlainObjectBase< MatType > >
 
struct  EigenFromPyConverter
 
struct  EigenSolverVisitor
 
struct  EigenToPy
 
struct  EigenToPy< Eigen::Ref< MatType, Options, Stride >, _Scalar >
 
struct  EigenToPyConverter
 
struct  EulerAnglesConvertor
 
class  Exception
 
class  ExceptionIndex
 
struct  FromTypeToType
 
struct  FromTypeToType< double, long double >
 
struct  FromTypeToType< double, std::complex< double > >
 
struct  FromTypeToType< double, std::complex< long double > >
 
struct  FromTypeToType< float, double >
 
struct  FromTypeToType< float, long double >
 
struct  FromTypeToType< float, std::complex< double > >
 
struct  FromTypeToType< float, std::complex< float > >
 
struct  FromTypeToType< float, std::complex< long double > >
 
struct  FromTypeToType< int, double >
 
struct  FromTypeToType< int, float >
 
struct  FromTypeToType< int, long >
 
struct  FromTypeToType< int, long double >
 
struct  FromTypeToType< int, std::complex< double > >
 
struct  FromTypeToType< int, std::complex< float > >
 
struct  FromTypeToType< int, std::complex< long double > >
 
struct  FromTypeToType< long, double >
 
struct  FromTypeToType< long, float >
 
struct  FromTypeToType< long, long double >
 
struct  FromTypeToType< long, std::complex< double > >
 
struct  FromTypeToType< long, std::complex< float > >
 
struct  FromTypeToType< long, std::complex< long double > >
 
struct  FromTypeToType< SCALAR, SCALAR >
 
struct  IdentityPreconditionerVisitor
 
struct  IterativeSolverVisitor
 
struct  LDLTSolverVisitor
 
struct  LeastSquaresConjugateGradientVisitor
 
struct  LimitedBFGSPreconditionerBaseVisitor
 
struct  LLTSolverVisitor
 
struct  NumpyAllocator
 
struct  NumpyAllocator< const MatType & >
 
struct  NumpyAllocator< MatType & >
 
struct  NumpyEquivalentType
 
struct  NumpyEquivalentType< bool >
 
struct  NumpyEquivalentType< double >
 
struct  NumpyEquivalentType< float >
 
struct  NumpyEquivalentType< int >
 
struct  NumpyEquivalentType< long >
 
struct  NumpyEquivalentType< long double >
 
struct  NumpyEquivalentType< std::complex< double > >
 
struct  NumpyEquivalentType< std::complex< float > >
 
struct  NumpyEquivalentType< std::complex< long double > >
 
struct  NumpyMap
 
struct  NumpyMapTraits
 
struct  NumpyMapTraits< MatType, InputScalar, AlignmentValue, Stride, false >
 
struct  NumpyMapTraits< MatType, InputScalar, AlignmentValue, Stride, true >
 
struct  NumpyType
 
struct  PreconditionerBaseVisitor
 
struct  PySwigObject
 
class  QuaternionVisitor
 
struct  Register
 Structure collecting all the types registers in Numpy via EigenPy. More...
 
struct  scalar_name
 
struct  scalar_name< double >
 
struct  scalar_name< float >
 
struct  scalar_name< long double >
 
struct  scalar_name< std::complex< Scalar > >
 
struct  SelfAdjointEigenSolverVisitor
 
struct  SolversScope
 
struct  SparseSolverVisitor
 
struct  StrideType
 
struct  StrideType< MatType, InnerStride, OuterStride, true >
 

Enumerations

enum  NP_TYPE { MATRIX_TYPE, ARRAY_TYPE }
 

Functions

template<typename T >
bool check_registration ()
 Check at runtime the registration of the type T inside the boost python registry. More...
 
bool EIGENPY_DLLAPI checkVersionAtLeast (unsigned int major_version, unsigned int minor_version, unsigned int patch_version)
 Checks if the current version of EigenPy is at least the version provided by the input arguments. More...
 
template<typename MatOrRefType >
void eigen_from_py_construct (PyObject *pyObj, bp::converter::rvalue_from_python_stage1_data *memory)
 
void EIGENPY_DLLAPI enableEigenPy ()
 
template<typename MatType , typename EigenEquivalentType >
EIGENPY_DEPRECATED void enableEigenPySpecific ()
 
template<typename MatType >
void enableEigenPySpecific ()
 
template<typename T >
void expose ()
 Call the expose function of a given type T. More...
 
void EIGENPY_DLLAPI exposeAngleAxis ()
 
void exposeComputationInfo ()
 
void EIGENPY_DLLAPI exposeDecompositions ()
 
void EIGENPY_DLLAPI exposeGeometryConversion ()
 
void exposeMatrixBool ()
 
void exposeMatrixComplexDouble ()
 
void exposeMatrixComplexFloat ()
 
void exposeMatrixComplexLongDouble ()
 
void exposeMatrixDouble ()
 
void exposeMatrixFloat ()
 
void exposeMatrixInt ()
 
void exposeMatrixLong ()
 
void exposeMatrixLongDouble ()
 
void EIGENPY_DLLAPI exposePreconditioners ()
 
void EIGENPY_DLLAPI exposeQuaternion ()
 
void EIGENPY_DLLAPI exposeSolvers ()
 
template<typename Scalar , int Options>
EIGEN_DONT_INLINE void exposeType ()
 
template<typename Scalar >
EIGEN_DONT_INLINE void exposeType ()
 
PySwigObjectget_PySwigObject (PyObject *pyObj)
 
void EIGENPY_DLLAPI import_numpy ()
 
bool is_aligned (void *ptr, std::size_t alignment)
 
template<typename MatrixType1 , typename MatrixType2 >
EIGEN_DONT_INLINE bool is_approx (const Eigen::MatrixBase< MatrixType1 > &mat1, const Eigen::MatrixBase< MatrixType2 > &mat2, const typename MatrixType1::Scalar &prec)
 
template<typename MatrixType1 , typename MatrixType2 >
EIGEN_DONT_INLINE bool is_approx (const Eigen::MatrixBase< MatrixType1 > &mat1, const Eigen::MatrixBase< MatrixType2 > &mat2)
 
template<typename Scalar >
bool isNumpyNativeType ()
 
template<typename Scalar >
bool np_type_is_convertible_into_scalar (const int np_type)
 
std::string EIGENPY_DLLAPI printVersion (const std::string &delimiter=".")
 Returns the current version of EigenPy as a string using the following standard: EIGENPY_MINOR_VERSION.EIGENPY_MINOR_VERSION.EIGENPY_PATCH_VERSION. More...
 
int EIGENPY_DLLAPI PyArray_TypeNum (PyTypeObject *type)
 
template<typename T >
bool register_symbolic_link_to_registered_type ()
 Symlink to the current scope the already registered class T. More...
 
template<typename Scalar >
void registerCommonUfunc ()
 
template<typename Scalar >
int registerNewType (PyTypeObject *py_type_ptr=NULL)
 
void seed (unsigned int seed_value)
 

Enumeration Type Documentation

Enumerator
MATRIX_TYPE 
ARRAY_TYPE 

Definition at line 69 of file numpy-type.hpp.

Function Documentation

template<typename T >
bool eigenpy::check_registration ( )
inline

Check at runtime the registration of the type T inside the boost python registry.

Template Parameters
TThe type to check the registration.
Returns
true if the type T is already registered.

Definition at line 21 of file registration.hpp.

bool eigenpy::checkVersionAtLeast ( unsigned int  major_version,
unsigned int  minor_version,
unsigned int  patch_version 
)

Checks if the current version of EigenPy is at least the version provided by the input arguments.

Parameters
[in]major_versionMajor version to check.
[in]minor_versionMinor version to check.
[in]patch_versionPatch version to check.
Returns
true if the current version of EigenPy is greater than the version provided by the input arguments.

Definition at line 23 of file version.cpp.

template<typename MatOrRefType >
void eigenpy::eigen_from_py_construct ( PyObject *  pyObj,
bp::converter::rvalue_from_python_stage1_data *  memory 
)

Definition at line 264 of file eigen-from-python.hpp.

void eigenpy::enableEigenPy ( )

Definition at line 29 of file eigenpy.cpp.

template<typename MatType , typename EigenEquivalentType >
EIGENPY_DEPRECATED void eigenpy::enableEigenPySpecific ( )

Definition at line 72 of file details.hpp.

template<typename MatType >
void eigenpy::enableEigenPySpecific ( )

Definition at line 78 of file details.hpp.

template<typename T >
void eigenpy::expose ( )
inline

Call the expose function of a given type T.

Definition at line 25 of file expose.hpp.

void eigenpy::exposeAngleAxis ( )

Definition at line 14 of file angle-axis.cpp.

void eigenpy::exposeComputationInfo ( )
inline

Definition at line 12 of file computation-info.hpp.

void eigenpy::exposeDecompositions ( )

Definition at line 16 of file decompositions.cpp.

void eigenpy::exposeGeometryConversion ( )

Definition at line 12 of file geometry-conversion.cpp.

void eigenpy::exposeMatrixBool ( )

Definition at line 9 of file matrix-bool.cpp.

void eigenpy::exposeMatrixComplexDouble ( )

Definition at line 9 of file matrix-complex-double.cpp.

void eigenpy::exposeMatrixComplexFloat ( )

Definition at line 9 of file matrix-complex-float.cpp.

void eigenpy::exposeMatrixComplexLongDouble ( )

Definition at line 9 of file matrix-complex-long-double.cpp.

void eigenpy::exposeMatrixDouble ( )

Definition at line 9 of file matrix-double.cpp.

void eigenpy::exposeMatrixFloat ( )

Definition at line 9 of file matrix-float.cpp.

void eigenpy::exposeMatrixInt ( )

Definition at line 9 of file matrix-int.cpp.

void eigenpy::exposeMatrixLong ( )

Definition at line 9 of file matrix-long.cpp.

void eigenpy::exposeMatrixLongDouble ( )

Definition at line 9 of file matrix-long-double.cpp.

void EIGENPY_DLLAPI eigenpy::exposePreconditioners ( )
void eigenpy::exposeQuaternion ( )

Definition at line 14 of file quaternion.cpp.

void EIGENPY_DLLAPI eigenpy::exposeSolvers ( )
template<typename Scalar , int Options>
EIGEN_DONT_INLINE void eigenpy::exposeType ( )

Definition at line 35 of file eigenpy.hpp.

template<typename Scalar >
EIGEN_DONT_INLINE void eigenpy::exposeType ( )

Definition at line 63 of file eigenpy.hpp.

PySwigObject* eigenpy::get_PySwigObject ( PyObject *  pyObj)
inline

Definition at line 19 of file swig.hpp.

void eigenpy::import_numpy ( )

Definition at line 9 of file numpy.cpp.

bool eigenpy::is_aligned ( void *  ptr,
std::size_t  alignment 
)
inline

Definition at line 10 of file is-aligned.hpp.

template<typename MatrixType1 , typename MatrixType2 >
EIGEN_DONT_INLINE bool eigenpy::is_approx ( const Eigen::MatrixBase< MatrixType1 > &  mat1,
const Eigen::MatrixBase< MatrixType2 > &  mat2,
const typename MatrixType1::Scalar &  prec 
)
inline

Definition at line 13 of file is-approx.hpp.

template<typename MatrixType1 , typename MatrixType2 >
EIGEN_DONT_INLINE bool eigenpy::is_approx ( const Eigen::MatrixBase< MatrixType1 > &  mat1,
const Eigen::MatrixBase< MatrixType2 > &  mat2 
)
inline

Definition at line 21 of file is-approx.hpp.

template<typename Scalar >
bool eigenpy::isNumpyNativeType ( )

Definition at line 33 of file numpy-type.hpp.

template<typename Scalar >
bool eigenpy::np_type_is_convertible_into_scalar ( const int  np_type)

Definition at line 41 of file numpy-type.hpp.

std::string eigenpy::printVersion ( const std::string &  delimiter = ".")

Returns the current version of EigenPy as a string using the following standard: EIGENPY_MINOR_VERSION.EIGENPY_MINOR_VERSION.EIGENPY_PATCH_VERSION.

Definition at line 13 of file version.cpp.

int eigenpy::PyArray_TypeNum ( PyTypeObject *  type)

Definition at line 18 of file numpy.cpp.

template<typename T >
bool eigenpy::register_symbolic_link_to_registered_type ( )
inline

Symlink to the current scope the already registered class T.

 

Returns
true if the type T is effectively symlinked.
Template Parameters
TThe type to symlink.

Definition at line 41 of file registration.hpp.

template<typename Scalar >
void eigenpy::registerCommonUfunc ( )

Definition at line 128 of file ufunc.hpp.

template<typename Scalar >
int eigenpy::registerNewType ( PyTypeObject *  py_type_ptr = NULL)

Definition at line 170 of file user-type.hpp.

void eigenpy::seed ( unsigned int  seed_value)

Definition at line 12 of file eigenpy.cpp.



eigenpy
Author(s): Justin Carpentier, Nicolas Mansard
autogenerated on Sat Apr 17 2021 02:37:59