Ceigenpy::aligned_instance< Data > | |
►Ceigenpy::aligned_instance< value_holder< Derived > > | |
Cboost::python::objects::instance< value_holder< Derived > > | |
Ceigenpy::aligned_storage< size, alignment > | |
Ceigenpy::aligned_storage< sizeof(Data)> | |
Ceigenpy::aligned_storage< sizeof(value_holder< Derived >)> | |
►Carg_lvalue_from_python_base | |
Cboost::python::converter::reference_arg_from_python< std::vector< Type, Allocator > & > | |
►CAstVisitor | |
Comniidl_be_python_with_docstring.CommentToConstVisitor | |
CBase< Matrix > | |
Ceigenpy::details::build_list< vector_type, NoProxy > | |
Ceigenpy::details::build_list< vector_type, true > | |
Ceigenpy::call< T > | Allows a template specialization |
Ceigenpy::call< Eigen::AngleAxis< Scalar > > | |
Ceigenpy::call< Eigen::Quaternion< Scalar, Options > > | |
Ceigenpy::call_destructor< T > | |
Ceigenpy::cast< From, To > | Default cast algo to cast a From to To. Can be specialized for any types |
Ceigenpy::details::cast< Scalar, NewScalar, EigenBase, cast_is_valid > | |
Ceigenpy::details::cast< Scalar, NewScalar, EigenBase, false > | |
Ceigenpy::details::check_swap_impl< EigenType, BaseType > | |
►Ceigenpy::details::check_swap_impl_matrix< MatType > | |
Ceigenpy::details::check_swap_impl< MatType, Eigen::MatrixBase< MatType > > | |
Ceigenpy::Register::Compare_PyTypeObject | |
Ceigenpy::Register::Compare_TypeInfo | |
Ceigenpy::internal::contains_algo< T, has_operator_equal_value > | |
Ceigenpy::internal::contains_algo< T, false > | |
Ceigenpy::internal::contains_algo< T, true > | |
Ceigenpy::details::copy_if_non_const< MatType, is_const > | |
Ceigenpy::details::copy_if_non_const< const MatType, true > | |
CCustomType< Scalar > | |
Ceigenpy::internal::OffsetOf< T >::Data | |
►Cdef_visitor | |
Ceigenpy::AngleAxisVisitor< AngleAxis > | |
Ceigenpy::BFGSPreconditionerBaseVisitor< Preconditioner > | |
Ceigenpy::ConjugateGradientVisitor< ConjugateGradient > | |
Ceigenpy::CopyableVisitor< C > | Add the Python method copy to allow a copy of this by calling the copy constructor |
Ceigenpy::details::overload_base_get_item_for_std_map< Container > | |
Ceigenpy::details::overload_base_get_item_for_std_vector< Container > | Change the behaviour of indexing (method getitem in Python). This is suitable for container of Eigen matrix objects if you want to mutate them |
Ceigenpy::EigenSolverVisitor< _MatrixType > | |
Ceigenpy::EmptyPythonVisitor | |
Ceigenpy::IterativeSolverBaseVisitor< _Solver > | |
Ceigenpy::IterativeSolverVisitor< IterativeSolver > | |
Ceigenpy::LDLTSolverVisitor< _MatrixType > | |
Ceigenpy::LeastSquaresConjugateGradientVisitor< LeastSquaresConjugateGradient > | |
Ceigenpy::LimitedBFGSPreconditionerBaseVisitor< Preconditioner > | |
Ceigenpy::LLTSolverVisitor< _MatrixType > | |
Ceigenpy::MINRESSolverVisitor< _MatrixType > | |
Ceigenpy::PreconditionerBaseVisitor< Preconditioner > | |
Ceigenpy::QuaternionVisitor< Quaternion > | |
Ceigenpy::SelfAdjointEigenSolverVisitor< _MatrixType > | |
Ceigenpy::SparseSolverVisitor< SparseSolver > | |
►Ceigenpy::PreconditionerBaseVisitor< Eigen::DiagonalPreconditioner< Scalar > > | |
Ceigenpy::DiagonalPreconditionerVisitor< Scalar > | |
►Ceigenpy::PreconditionerBaseVisitor< Eigen::IdentityPreconditioner > | |
Ceigenpy::IdentityPreconditionerVisitor | |
Ceigenpy::eigen_allocator_impl< EigenType, BaseType > | |
►Ceigenpy::eigen_allocator_impl< EigenType > | |
Ceigenpy::EigenAllocator< EigenType > | |
►Ceigenpy::eigen_allocator_impl_matrix< MatType > | |
Ceigenpy::eigen_allocator_impl< MatType, Eigen::MatrixBase< MatType > > | |
►Ceigenpy::eigen_allocator_impl_matrix< const MatType > | |
Ceigenpy::eigen_allocator_impl< const MatType, const Eigen::MatrixBase< MatType > > | |
Ceigenpy::eigen_from_py_converter_impl< EigenType, BaseType > | |
►Ceigenpy::eigen_from_py_converter_impl< EigenType > | |
Ceigenpy::EigenFromPyConverter< EigenType > | |
Ceigenpy::eigen_from_py_converter_impl< MatType, Eigen::MatrixBase< MatType > > | |
Ceigenpy::eigen_from_py_converter_impl< TensorType, Eigen::TensorBase< TensorType > > | |
►Ceigenpy::eigen_from_py_impl< EigenType, BaseType > | |
►Ceigenpy::EigenFromPy< MatType > | |
Ceigenpy::EigenFromPy< Eigen::EigenBase< MatType >, typename MatType::Scalar > | |
Ceigenpy::EigenFromPy< Eigen::MatrixBase< MatType > > | |
Ceigenpy::EigenFromPy< Eigen::PlainObjectBase< MatType > > | |
►Ceigenpy::EigenFromPy< TensorType > | |
Ceigenpy::EigenFromPy< Eigen::TensorBase< TensorType > > | |
►Ceigenpy::eigen_from_py_impl< EigenType > | |
Ceigenpy::EigenFromPy< EigenType, _Scalar > | |
Ceigenpy::eigen_from_py_impl< MatType, Eigen::MatrixBase< MatType > > | |
Ceigenpy::eigen_from_py_impl< TensorType, Eigen::TensorBase< TensorType > > | |
Ceigenpy::eigen_to_py_impl< EigenType, BaseType > | |
►Ceigenpy::eigen_to_py_impl< EigenType > | |
Ceigenpy::EigenToPy< EigenType, _Scalar > | |
►Ceigenpy::eigen_to_py_impl_matrix< MatType > | |
Ceigenpy::eigen_to_py_impl< MatType, Eigen::MatrixBase< MatType > > | |
►Ceigenpy::eigen_to_py_impl_matrix< const MatType &> | |
Ceigenpy::eigen_to_py_impl< const MatType &, const Eigen::MatrixBase< MatType > > | |
►Ceigenpy::eigen_to_py_impl_matrix< const MatType > | |
Ceigenpy::eigen_to_py_impl< const MatType, const Eigen::MatrixBase< MatType > > | |
►Ceigenpy::eigen_to_py_impl_matrix< MatType &> | |
Ceigenpy::eigen_to_py_impl< MatType &, Eigen::MatrixBase< MatType > > | |
Ceigenpy::EigenFromPy< const Eigen::TensorRef< const TensorType > > | |
Ceigenpy::EigenFromPy< Eigen::TensorRef< TensorType > > | |
Ceigenpy::EigenToPyConverter< MatType > | |
Ceigenpy::EulerAnglesConvertor< Scalar, Options > | |
►Cexception | |
►Ceigenpy::Exception | |
Ceigenpy::ExceptionIndex | |
►Cexpected_pytype_for_arg | |
Cboost::python::converter::expected_pytype_for_arg< boost::optional< T > > | |
Ceigenpy::expected_pytype_for_arg< EigenType, BaseType > | |
►Ceigenpy::expected_pytype_for_arg< Eigen::Matrix< Scalar, Rows, Cols, Options, MaxRows, MaxCols > > | |
Cboost::python::converter::expected_pytype_for_arg< Eigen::Matrix< Scalar, Rows, Cols, Options, MaxRows, MaxCols > > | |
►Ceigenpy::expected_pytype_for_arg< Eigen::Tensor< Scalar, Rank, Options, IndexType > > | |
Cboost::python::converter::expected_pytype_for_arg< Eigen::Tensor< Scalar, Rank, Options, IndexType > > | |
Ceigenpy::expected_pytype_for_arg< MatType, Eigen::MatrixBase< MatType > > | |
Ceigenpy::expected_pytype_for_arg< TensorType, Eigen::TensorBase< TensorType > > | |
Ceigenpy::expose_eigen_type_impl< EigenType, BaseType, Scalar > | |
Ceigenpy::expose_eigen_type_impl< MatType, Eigen::MatrixBase< MatType >, Scalar > | |
►Cextract_rvalue | |
Cboost::python::extract_to_eigen_ref< MatrixType > | |
►Cboost::python::extract_to_eigen_ref< Eigen::Matrix< Scalar, Rows, Cols, Options, MaxRows, MaxCols > > | |
Cboost::python::extract< Eigen::Matrix< Scalar, Rows, Cols, Options, MaxRows, MaxCols > & > | Specialization of the boost::python::extract struct for references to Eigen matrix objects |
►Cboost::python::extract_to_eigen_ref< Eigen::MatrixBase< Derived > > | |
Cboost::python::extract< Eigen::MatrixBase< Derived > & > | |
►Cboost::python::extract_to_eigen_ref< Eigen::RefBase< Derived > > | |
Cboost::python::extract< Eigen::RefBase< Derived > & > | |
►Cfalse_type | |
Ceigenpy::FromTypeToType< SCALAR1, SCALAR2 > | |
Ceigenpy::get_eigen_base_type< EigenType > | |
Ceigenpy::get_eigen_ref_plain_type< EigenType > | |
Ceigenpy::get_eigen_ref_plain_type< Eigen::Ref< MatType, Options, Stride > > | |
Ceigenpy::internal::getitem< T > | |
Chas_ref_member | |
Cboost::python::converter::implicit< Quaternion, Eigen::QuaternionBase< Quaternion > > | |
Ceigenpy::details::init_matrix_or_array< MatType, IsVectorAtCompileTime > | |
Ceigenpy::details::init_matrix_or_array< MatType, true > | |
►Cmodify_block | |
Cmodify_block_wrap | |
Cmystruct | |
►CMyVirtualClass | |
Ctest_bind_virtual.ImplClass | |
►CMyVirtualClass | |
CVirtualClassWrapper | Wrapper classes |
►CMyVirtualData | |
CDataWrapper | |
►CMyVirtualData | |
Ctest_bind_virtual.ImplData | |
Ceigenpy::detail::NoneToPython< NoneType > | |
Ceigenpy::detail::nullopt_helper< OptionalTpl > | |
Ceigenpy::detail::nullopt_helper< boost::optional > | |
►Ceigenpy::numpy_allocator_impl< EigenType, BaseType > | |
Ceigenpy::NumpyAllocator< EigenType, BaseType > | |
►Ceigenpy::numpy_allocator_impl_matrix< MatType > | |
Ceigenpy::numpy_allocator_impl< MatType, Eigen::MatrixBase< typename remove_const_reference< MatType >::type > > | |
Ceigenpy::numpy_allocator_impl_matrix< const MatType & > | |
►Ceigenpy::numpy_allocator_impl_matrix< const MatType &> | |
Ceigenpy::numpy_allocator_impl< const MatType &, const Eigen::MatrixBase< MatType > > | |
►Ceigenpy::numpy_allocator_impl_matrix< const MatType > | |
Ceigenpy::numpy_allocator_impl< const MatType, const Eigen::MatrixBase< typename remove_const_reference< MatType >::type > > | |
Ceigenpy::numpy_allocator_impl_matrix< MatType & > | |
Ceigenpy::numpy_map_impl< EigenType, InputScalar, AlignmentValue, Stride, BaseType > | |
►Ceigenpy::numpy_map_impl< EigenType, InputScalar, AlignmentValue, Stride > | |
Ceigenpy::NumpyMap< EigenType, InputScalar, AlignmentValue, Stride > | |
Ceigenpy::numpy_map_impl_matrix< MatType, InputScalar, AlignmentValue, Stride, IsVector > | |
►Ceigenpy::numpy_map_impl_matrix< const MatType, InputScalar, AlignmentValue, Stride > | |
Ceigenpy::numpy_map_impl< const MatType, InputScalar, AlignmentValue, Stride, const Eigen::MatrixBase< MatType > > | |
►Ceigenpy::numpy_map_impl_matrix< MatType, InputScalar, AlignmentValue, Stride > | |
Ceigenpy::numpy_map_impl< MatType, InputScalar, AlignmentValue, Stride, Eigen::MatrixBase< MatType > > | |
Ceigenpy::numpy_map_impl_matrix< MatType, InputScalar, AlignmentValue, Stride, false > | |
Ceigenpy::numpy_map_impl_matrix< MatType, InputScalar, AlignmentValue, Stride, true > | |
Ceigenpy::NumpyEquivalentType< Scalar > | |
Ceigenpy::NumpyEquivalentType< bool > | |
Ceigenpy::NumpyEquivalentType< double > | |
Ceigenpy::NumpyEquivalentType< float > | |
Ceigenpy::NumpyEquivalentType< int > | |
Ceigenpy::NumpyEquivalentType< long > | |
Ceigenpy::NumpyEquivalentType< long double > | |
Ceigenpy::NumpyEquivalentType< long long > | |
Ceigenpy::NumpyEquivalentType< std::complex< double > > | |
Ceigenpy::NumpyEquivalentType< std::complex< float > > | |
Ceigenpy::NumpyEquivalentType< std::complex< long double > > | |
Ceigenpy::NumpyEquivalentType< unsigned int > | |
Ceigenpy::NumpyEquivalentType< unsigned long > | |
Ceigenpy::NumpyType | |
CEigen::NumTraits< CustomType< Scalar > > | Eigen::NumTraits<> specialization for casadi::SX |
►Cobject | |
Cgit-archive-all.GitArchiver | |
Csetup.pkg_config | |
Ceigenpy::internal::OffsetOf< T > | |
Ceigenpy::OptionalConverter< T, OptionalTpl > | |
Ceigenpy::detail::OptionalFromPython< T, OptionalTpl > | |
Ceigenpy::detail::OptionalToPython< T, OptionalTpl > | |
►Cpickle_suite | |
Ceigenpy::PickleVector< VecType > | Create a pickle interface for the std::vector |
Ceigenpy::PySwigObject | |
Cboost::python::detail::referent_storage< const Eigen::Matrix< Scalar, Rows, Cols, Options, MaxRows, MaxCols > & > | |
Cboost::python::detail::referent_storage< const Eigen::Quaternion< Scalar, Options > & > | |
Cboost::python::detail::referent_storage< const Eigen::TensorRef< const TensorType > & > | |
Cboost::python::detail::referent_storage< Eigen::Matrix< Scalar, Rows, Cols, Options, MaxRows, MaxCols > & > | |
Cboost::python::detail::referent_storage< Eigen::Quaternion< Scalar, Options > & > | |
Cboost::python::detail::referent_storage< Eigen::TensorRef< TensorType > & > | |
Ceigenpy::Register | Structure collecting all the types registers in Numpy via EigenPy |
Ceigenpy::remove_const_reference< T > | |
►Crvalue_from_python_storage | |
Cboost::python::converter::rvalue_from_python_data< const Eigen::Ref< const MatType, Options, Stride > & > | |
Cboost::python::converter::rvalue_from_python_data< Eigen::Ref< MatType, Options, Stride > & > | |
Ceigenpy::rvalue_from_python_data< T > | |
►Ceigenpy::rvalue_from_python_data< Derived const &> | |
Cboost::python::converter::rvalue_from_python_data< Eigen::EigenBase< Derived > const & > | |
Cboost::python::converter::rvalue_from_python_data< Eigen::MatrixBase< Derived > const & > | |
Cboost::python::converter::rvalue_from_python_data< Eigen::PlainObjectBase< Derived > const & > | |
Cboost::python::converter::rvalue_from_python_data< Eigen::TensorBase< Derived > const & > | |
►Ceigenpy::rvalue_from_python_data< Eigen::Matrix< Scalar, Rows, Cols, Options, MaxRows, MaxCols > const &> | |
Cboost::python::converter::rvalue_from_python_data< Eigen::Matrix< Scalar, Rows, Cols, Options, MaxRows, MaxCols > const & > | |
►Ceigenpy::rvalue_from_python_data< Eigen::Tensor< Scalar, Rank, Options, IndexType > const &> | |
Cboost::python::converter::rvalue_from_python_data< Eigen::Tensor< Scalar, Rank, Options, IndexType > const & > | |
►Ceigenpy::rvalue_from_python_data< Quaternion const &> | |
Cboost::python::converter::rvalue_from_python_data< Eigen::QuaternionBase< Quaternion > const & > | Template specialization of rvalue_from_python_data |
Ceigenpy::scalar_name< Scalar > | |
Ceigenpy::scalar_name< double > | |
Ceigenpy::scalar_name< float > | |
Ceigenpy::scalar_name< long double > | |
Ceigenpy::scalar_name< std::complex< Scalar > > | |
Ceigenpy::SolversScope | |
Ceigenpy::internal::SpecialMethods< T, type_code > | |
Ceigenpy::internal::SpecialMethods< T, NPY_USERDEF > | |
►Ceigenpy::StdContainerFromPythonList< vector_type, NoProxy > | Register the conversion from a Python list to a std::vector |
Ceigenpy::StdVectorPythonVisitor< vector_type, NoProxy, EnableFromPythonListConverter > | Expose an std::vector from a type given as template argument |
Ceigenpy::stride_type< EigenType, InnerStride, OuterStride, BaseType > | |
Ceigenpy::stride_type< const MatrixType, InnerStride, OuterStride, const Eigen::MatrixBase< MatrixType > > | |
Ceigenpy::stride_type< MatrixType, InnerStride, OuterStride, Eigen::MatrixBase< MatrixType > > | |
Ceigenpy::stride_type_matrix< MatType, InnerStride, OuterStride, IsVectorAtCompileTime > | |
Ceigenpy::stride_type_matrix< MatType, InnerStride, OuterStride, true > | |
Ceigenpy::StrideType< EigenType, InnerStride, OuterStride > | |
CTensorContainer< Scalar, Rank > | |
Cboost::python::to_python_indirect_eigen< MatrixRef, MakeHolder > | |
►Cboost::python::to_python_indirect_eigen< const Eigen::Matrix< Scalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime > &, MakeHolder > | |
Cboost::python::to_python_indirect< const Eigen::Matrix< Scalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime > &, MakeHolder > | |
►Cboost::python::to_python_indirect_eigen< Eigen::Matrix< Scalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime > &, MakeHolder > | |
Cboost::python::to_python_indirect< Eigen::Matrix< Scalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime > &, MakeHolder > | |
►Ctrue_type | |
Ceigenpy::FromTypeToType< double, long double > | |
Ceigenpy::FromTypeToType< double, std::complex< double > > | |
Ceigenpy::FromTypeToType< double, std::complex< long double > > | |
Ceigenpy::FromTypeToType< float, double > | |
Ceigenpy::FromTypeToType< float, long double > | |
Ceigenpy::FromTypeToType< float, std::complex< double > > | |
Ceigenpy::FromTypeToType< float, std::complex< float > > | |
Ceigenpy::FromTypeToType< float, std::complex< long double > > | |
Ceigenpy::FromTypeToType< int, double > | |
Ceigenpy::FromTypeToType< int, float > | |
Ceigenpy::FromTypeToType< int, long > | |
Ceigenpy::FromTypeToType< int, long double > | |
Ceigenpy::FromTypeToType< int, std::complex< double > > | |
Ceigenpy::FromTypeToType< int, std::complex< float > > | |
Ceigenpy::FromTypeToType< int, std::complex< long double > > | |
Ceigenpy::FromTypeToType< long, double > | |
Ceigenpy::FromTypeToType< long, float > | |
Ceigenpy::FromTypeToType< long, long double > | |
Ceigenpy::FromTypeToType< long, std::complex< double > > | |
Ceigenpy::FromTypeToType< long, std::complex< float > > | |
Ceigenpy::FromTypeToType< long, std::complex< long double > > | |
Ceigenpy::FromTypeToType< SCALAR, SCALAR > | |
Ceigenpy::internal::has_operator_equal< bool > | |
Ceigenpy::aligned_storage< size, alignment >::type | |
►Ctype | |
►Ceigenpy::internal::has_operator_equal< T > | |
Ceigenpy::internal::has_operator_equal< std::vector< T, A > > | |
►Ceigenpy::internal::has_operator_equal< EigenObject::Scalar > | |
Ceigenpy::internal::has_operator_equal< Eigen::EigenBase< EigenObject > > | |
►Cvector_indexing_suite | |
Ceigenpy::internal::contains_vector_derived_policies< Container, NoProxy > | |
Ceigenpy::StdVectorPythonVisitor< vector_type, NoProxy, EnableFromPythonListConverter > | Expose an std::vector from a type given as template argument |
►Cwrapper | |
CDataWrapper | |
Cmodify_block_wrap | |
CVirtualClassWrapper | Wrapper classes |