| ►CAbstractContextManager | |
| Ceigenpy.windows_dll_manager.DllDirectoryManager | |
| 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 >)> | |
| Ceigenpy::AngleAxisVisitor< AngleAxis > | |
| Ceigenpy::details::VariantConverter< Variant >::apply< T > | |
| Ceigenpy::details::StdUniquePtrResultConverter::apply< T > | |
| Ceigenpy::details::InternalStdUniquePtrConverter::apply< T > | |
| ►Carg_lvalue_from_python_base | |
| Cboost::python::converter::reference_arg_from_python< std::vector< Type, Allocator > & > | |
| Ceigenpy::array_indexing_suite< Container, NoProxy, SliceAllocator, DerivedPolicies > | |
| ►Ceigenpy::array_indexing_suite< Container, NoProxy, SliceAllocator, final_array_derived_policies< Container, NoProxy, SliceAllocator > > | |
| Ceigenpy::details::final_array_derived_policies< Container, NoProxy, SliceAllocator > | |
| ►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::details::cast< Scalar, NewScalar, EigenBase, cast_is_valid > | |
| 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, 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::details::container_traits< Container > | |
| Ceigenpy::details::container_traits< std::array< _Tp, Size > > | |
| 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 > | |
| CCustomTestStruct | |
| CCustomType< Scalar > | |
| Ceigenpy::internal::OffsetOf< T >::Data | |
| Ceigenpy::internal::def_pickle_std_vector< vector_type, T_picklable > | |
| Ceigenpy::internal::def_pickle_std_vector< vector_type, true > | |
| ►Cdef_visitor | |
| Ceigenpy::AccelerateImplVisitor< AccelerateDerived > | |
| Ceigenpy::BFGSPreconditionerBaseVisitor< Preconditioner > | |
| Ceigenpy::CholmodBaseVisitor< CholdmodDerived > | |
| Ceigenpy::CholmodDecompositionVisitor< CholdmodDerived > | |
| Ceigenpy::CholmodSimplicialLDLTVisitor< MatrixType_, UpLo_ > | |
| Ceigenpy::CholmodSimplicialLLTVisitor< MatrixType_, UpLo_ > | |
| Ceigenpy::CholmodSupernodalLLTVisitor< MatrixType_, UpLo_ > | |
| Ceigenpy::ColPivHouseholderQRSolverVisitor< _MatrixType > | |
| Ceigenpy::CompleteOrthogonalDecompositionSolverVisitor< _MatrixType > | |
| 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_vector< Container > | Change the behavior of indexing (method getitem in Python). This is suitable for container of Eigen matrix objects if you want to mutate them |
| Ceigenpy::EigenBaseVisitor< Derived > | |
| Ceigenpy::EigenSolverVisitor< _MatrixType > | |
| Ceigenpy::EmptyPythonVisitor | |
| Ceigenpy::FullPivHouseholderQRSolverVisitor< _MatrixType > | |
| Ceigenpy::HouseholderQRSolverVisitor< _MatrixType > | |
| Ceigenpy::IdVisitor< C > | Add the Python method id to retrieving a unique id for a given object exposed with Boost.Python |
| Ceigenpy::internal::ExposeStdMethodToStdVector< Container, NoProxy, CoVisitor > | Add standard method to a std::vector |
| Ceigenpy::IterativeSolverBaseVisitor< _Solver > | |
| Ceigenpy::IterativeSolverVisitor< IterativeSolver > | |
| Ceigenpy::LDLTSolverVisitor< _MatrixType > | |
| Ceigenpy::LeastSquaresConjugateGradientVisitor< LeastSquaresConjugateGradient > | |
| Ceigenpy::LimitedBFGSPreconditionerBaseVisitor< Preconditioner > | |
| Ceigenpy::LLTSolverVisitor< _MatrixType > | |
| Ceigenpy::MINRESSolverVisitor< _MatrixType > | |
| Ceigenpy::overload_base_get_item_for_map< Container > | Change the behavior of indexing (method getitem in Python). This is suitable e.g. for container of Eigen matrix objects if you want to mutate them |
| Ceigenpy::PermutationMatrixVisitor< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex_ > | |
| Ceigenpy::PreconditionerBaseVisitor< Preconditioner > | |
| Ceigenpy::SelfAdjointEigenSolverVisitor< _MatrixType > | |
| Ceigenpy::SimplicialCholeskyVisitor< SimplicialDerived > | |
| Ceigenpy::SimplicialLDLTVisitor< _MatrixType, _UpLo, _Ordering > | |
| Ceigenpy::SimplicialLLTVisitor< _MatrixType, _UpLo, _Ordering > | |
| Ceigenpy::SparseSolverBaseVisitor< SimplicialDerived > | |
| Ceigenpy::SparseSolverVisitor< SparseSolver > | |
| Ceigenpy::TypeInfoVisitor< C > | Add the Python method type_info to query information of a type |
| ►Ceigenpy::PreconditionerBaseVisitor< Eigen::DiagonalPreconditioner< Scalar > > | |
| Ceigenpy::DiagonalPreconditionerVisitor< Scalar > | |
| ►Ceigenpy::PreconditionerBaseVisitor< Eigen::IdentityPreconditioner > | |
| Ceigenpy::IdentityPreconditionerVisitor | |
| ►Cdefault_call_policies | |
| ►Ceigenpy::deprecation_warning_policy< DeprecationType::DEPRECATION, bp::default_call_policies > | |
| Ceigenpy::deprecated_function< deprecation_type, BasePolicy > | |
| Ceigenpy::deprecated_member< deprecation_type, BasePolicy > | |
| Ceigenpy::deprecation_warning_policy< deprecation_type, BasePolicy > | A Boost.Python call policy which triggers a Python warning on precall |
| Ceigenpy::StdUniquePtrCallPolicies | |
| ►Ceigenpy::dict_to_map< Container > | |
| Ceigenpy::GenericMapVisitor< Container, NoProxy > | Expose the map-like container, e.g. (std::map) |
| CDummy | |
| Ceigenpy::eigen_allocator_impl< EigenType, BaseType > | |
| ►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< SparseMatrixType, Eigen::SparseMatrixBase< SparseMatrixType > > | |
| Ceigenpy::eigen_from_py_converter_impl< TensorType, Eigen::TensorBase< TensorType > > | |
| Ceigenpy::eigen_from_py_impl< EigenType, BaseType > | |
| ►Ceigenpy::eigen_from_py_impl< EigenType > | |
| Ceigenpy::EigenFromPy< EigenType, Scalar > | |
| ►Ceigenpy::eigen_from_py_impl< MatType > | |
| ►Ceigenpy::EigenFromPy< MatType > | |
| Ceigenpy::EigenFromPy< Eigen::EigenBase< MatType >, typename MatType::Scalar > | |
| Ceigenpy::EigenFromPy< Eigen::MatrixBase< MatType > > | |
| Ceigenpy::EigenFromPy< Eigen::PlainObjectBase< MatType > > | |
| Ceigenpy::eigen_from_py_impl< MatType, Eigen::MatrixBase< MatType > > | |
| ►Ceigenpy::eigen_from_py_impl< SparseMatrixType > | |
| ►Ceigenpy::EigenFromPy< SparseMatrixType > | |
| Ceigenpy::EigenFromPy< Eigen::SparseMatrixBase< SparseMatrixType > > | |
| Ceigenpy::eigen_from_py_impl< SparseMatrixType, Eigen::SparseMatrixBase< SparseMatrixType > > | |
| ►Ceigenpy::eigen_from_py_impl< TensorType > | |
| ►Ceigenpy::EigenFromPy< TensorType > | |
| Ceigenpy::EigenFromPy< Eigen::TensorBase< TensorType > > | |
| 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::eigen_to_py_impl_sparse_matrix< MatType > | |
| Ceigenpy::eigen_to_py_impl< MatType, Eigen::SparseMatrixBase< MatType > > | |
| ►Ceigenpy::eigen_to_py_impl_sparse_matrix< const MatType & > | |
| Ceigenpy::eigen_to_py_impl< const MatType &, const Eigen::SparseMatrixBase< MatType > > | |
| ►Ceigenpy::eigen_to_py_impl_sparse_matrix< const MatType > | |
| Ceigenpy::eigen_to_py_impl< const MatType, const Eigen::SparseMatrixBase< MatType > > | |
| ►Ceigenpy::eigen_to_py_impl_sparse_matrix< MatType & > | |
| Ceigenpy::eigen_to_py_impl< MatType &, Eigen::SparseMatrixBase< MatType > > | |
| Ceigenpy::EigenAllocator< EigenType > | |
| Ceigenpy::EigenFromPy< const Eigen::TensorRef< const TensorType > > | |
| Ceigenpy::EigenFromPy< Eigen::TensorRef< TensorType > > | |
| Ceigenpy::EigenToPyConverter< MatType > | |
| Ceigenpy::details::empty_variant< Variant > | |
| Ceigenpy::details::empty_variant< boost::variant< Alternatives... > > | |
| Ceigenpy::details::EmptyConvertible< Variant > | |
| 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 > | |
| Cboost::python::converter::expected_pytype_for_arg< Eigen::SparseMatrix< Scalar, Options, StorageIndex > > | |
| ►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::SparseMatrix< Scalar, Options, StorageIndex > > | |
| ►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< SparseMatrixType, Eigen::SparseMatrixBase< SparseMatrixType > > | |
| 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 > | |
| Ceigenpy::expose_eigen_type_impl< MatType, Eigen::SparseMatrixBase< 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::details::is_empty_variant< T > | |
| Ceigenpy::details::is_python_complex< T > | Trait to detect if T is a std::complex managed by Boost Python |
| ►CGenericMapVisitor< std::map< Key, T, std::less< Key >, std::allocator< std::pair< const Key, T >> >, false > | |
| Ceigenpy::StdMapPythonVisitor< Key, T, Compare, Allocator, NoProxy > | Expose an std::map from a type given as template argument |
| Ceigenpy::get_eigen_base_type< EigenType > | |
| Ceigenpy::get_eigen_plain_type< EigenType > | |
| Ceigenpy::get_eigen_plain_type< Eigen::Ref< MatType, Options, Stride > > | |
| Ceigenpy::internal::getitem< T > | |
| Ceigenpy::internal::has_operator_equal_impl< T1, T2 > | |
| 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 > | |
| ►Cintegral_constant | |
| Ceigenpy::details::is_class_or_union< T > | Trait to detect if T is a class or an union |
| Ceigenpy::details::is_python_primitive_type_helper< T > | |
| ►Ceigenpy::details::is_python_primitive_type_helper< remove_cvref< T >::type > | |
| Ceigenpy::details::is_python_primitive_type< T > | Trait to detect if T is a Python primitive type |
| Ceigenpy::details::InternalStdUniquePtrConverter | Result_converter of ReturnInternalStdUniquePtr |
| ►Cmap_indexing_suite | |
| Ceigenpy::emplace_set_derived_policies< Container, NoProxy > | |
| ►Ceigenpy::emplace_set_derived_policies< Container, false > | |
| Ceigenpy::GenericMapVisitor< Container, NoProxy > | Expose the map-like container, e.g. (std::map) |
| Cmodify_block | |
| Cmystruct | |
| ►CMyVirtualClass | |
| CVirtualClassWrapper | Wrapper classes |
| ►CMyVirtualClass | |
| Ctest_bind_virtual.ImplClass | |
| ►CMyVirtualData | |
| CDataWrapper | |
| ►CMyVirtualData | |
| Ctest_bind_virtual.ImplData | |
| Ceigenpy::detail::NoneToPython< NoneType > | |
| Ceigenpy::detail::nullopt_helper< OptionalTpl > | |
| Ceigenpy::detail::nullopt_helper< boost::optional > | |
| Ceigenpy::details::NumericConvertible< T, Variant > | Convert numeric type to Variant without ambiguity |
| Ceigenpy::details::NumericConvertibleImpl< T, Enable > | Implement convertible and expected_pytype for bool, integer and float |
| Ceigenpy::details::NumericConvertibleImpl< T, typename std::enable_if< std::is_floating_point< T >::value >::type > | |
| Ceigenpy::details::NumericConvertibleImpl< T, typename std::enable_if< std::is_same< T, bool >::value >::type > | |
| Ceigenpy::details::NumericConvertibleImpl< T, typename std::enable_if<!std::is_same< T, bool >::value &&std::is_integral< T >::value >::type > | |
| Ceigenpy::numpy_allocator_impl< EigenType, BaseType > | |
| ►Ceigenpy::numpy_allocator_impl< EigenType, typename get_eigen_base_type< EigenType >::type > | |
| 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< 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, EIGENPY_NO_ALIGNMENT_VALUE, typename StrideType< EigenType >::type > | |
| 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, Enable > | |
| Ceigenpy::NumpyEquivalentType< bool > | |
| Ceigenpy::NumpyEquivalentType< char > | |
| Ceigenpy::NumpyEquivalentType< double > | |
| Ceigenpy::NumpyEquivalentType< float > | |
| Ceigenpy::NumpyEquivalentType< int16_t > | |
| Ceigenpy::NumpyEquivalentType< int32_t > | |
| Ceigenpy::NumpyEquivalentType< int64_t > | |
| Ceigenpy::NumpyEquivalentType< int8_t > | |
| Ceigenpy::NumpyEquivalentType< long double > | |
| Ceigenpy::NumpyEquivalentType< std::complex< double > > | |
| Ceigenpy::NumpyEquivalentType< std::complex< float > > | |
| Ceigenpy::NumpyEquivalentType< std::complex< long double > > | |
| Ceigenpy::NumpyEquivalentType< uint16_t > | |
| Ceigenpy::NumpyEquivalentType< uint32_t > | |
| Ceigenpy::NumpyEquivalentType< uint64_t > | |
| Ceigenpy::NumpyEquivalentType< unsigned char > | |
| 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::PickleVector< Container > | |
| Ceigenpy::PickleMap< Container > | Create a pickle interface for the map type |
| Ceigenpy::PySwigObject | |
| Ceigenpy::QuaternionVisitor< Quaternion > | |
| 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::registration_class< W > | |
| Ceigenpy::remove_const_reference< T > | |
| ►Cremove_cv | |
| Ceigenpy::details::remove_cvref< T > | Trait to remove const& |
| ►Creturn_internal_reference | |
| Ceigenpy::ReturnInternalStdUniquePtr | |
| Ceigenpy::ReturnInternalVariant< Variant > | |
| ►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::SparseMatrixBase< 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::SparseMatrix< Scalar, Options, StorageIndex > const & > | |
| Cboost::python::converter::rvalue_from_python_data< Eigen::SparseMatrix< Scalar, Options, StorageIndex > 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::scipy_allocator_impl< EigenType, BaseType > | |
| ►Ceigenpy::scipy_allocator_impl< EigenType, typename get_eigen_base_type< EigenType >::type > | |
| Ceigenpy::ScipyAllocator< EigenType, BaseType > | |
| ►Ceigenpy::scipy_allocator_impl_sparse_matrix< MatType > | |
| Ceigenpy::scipy_allocator_impl< MatType, Eigen::SparseMatrixBase< typename remove_const_reference< MatType >::type > > | |
| ►Ceigenpy::scipy_allocator_impl_sparse_matrix< const MatType & > | |
| Ceigenpy::scipy_allocator_impl< const MatType &, const Eigen::SparseMatrixBase< MatType > > | |
| ►Ceigenpy::scipy_allocator_impl_sparse_matrix< const MatType > | |
| Ceigenpy::scipy_allocator_impl< const MatType, const Eigen::SparseMatrixBase< typename remove_const_reference< MatType >::type > > | |
| Ceigenpy::ScipyType | |
| Ceigenpy::SolversScope | |
| Ceigenpy::internal::SpecialMethods< T, type_code > | |
| Ceigenpy::internal::SpecialMethods< T, NPY_USERDEF > | |
| ►Cstatic_visitor | |
| Ceigenpy::details::VariantVisitorType< ResultType, boost::variant< Alternatives... > > | Boost::variant implementation |
| Ceigenpy::StdArrayPythonVisitor< array_type, NoProxy, SliceAllocator > | Expose an std::array (a C++11 fixed-size array) from a given type |
| CStdContainerFromPythonList | Defines traits for the container, used in |
| Ceigenpy::StdContainerFromPythonList< vector_type, NoProxy > | Register the conversion from a Python list to a std::vector |
| Ceigenpy::StdPairConverter< pair_type > | |
| Ceigenpy::details::StdUniquePtrResultConverter | Result_converter of StdUniquePtrCallPolicies |
| Ceigenpy::StdVectorPythonVisitor< vector_type, NoProxy, EnableFromPythonListConverter, pickable > | 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 > | |
| Ctest_struct | |
| 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::details::is_empty_variant< boost::blank > | |
| Ceigenpy::details::is_python_complex< std::complex< double > > | |
| Ceigenpy::details::is_python_complex< std::complex< float > > | From boost/python/converter/builtin_converters |
| Ceigenpy::details::is_python_complex< std::complex< long double > > | |
| Ceigenpy::aligned_storage< size, alignment >::type | |
| Ceigenpy::details::InternalStdUniquePtrConverter::apply< T >::type | |
| ►Ctype | |
| Ceigenpy::FromTypeToType< Source, Target > | |
| Ceigenpy::FromTypeToType< std::complex< ScalarSource >, std::complex< ScalarTarget > > | FromTypeToType specialization to manage std::complex |
| ►Ceigenpy::details::StdUniquePtrResultConverter::apply< T >::type | |
| Cboost::python::to_python_value< const std::unique_ptr< T > & > | Specialize to_python_value for std::unique_ptr |
| Ceigenpy::details::VariantConverter< Variant >::apply< T >::type | |
| ►Ctype | |
| Ceigenpy::has_operator_equal< T1, T2 > | |
| CUniquePtrHolder | |
| CV1 | |
| Ceigenpy::details::VariantAlternatives< Variant > | Allow to get all alternatives in a boost::mpl vector |
| Ceigenpy::details::VariantAlternatives< boost::variant< Alternatives... > > | |
| Ceigenpy::VariantConverter< Variant > | |
| Ceigenpy::details::VariantConverter< Variant > | |
| Ceigenpy::details::VariantConvertible< Variant > | Convert an Alternative type to a Variant |
| Ceigenpy::details::VariantVisitorType< ResultType, Variant > | Allow to use std::variant and boost::variant with the same API |
| ►Ceigenpy::details::VariantVisitorType< PyObject *, Variant > | |
| Ceigenpy::details::VariantRefToObject< Variant > | |
| Ceigenpy::details::VariantValueToObject< Variant > | |
| ►Cvector_indexing_suite | |
| Ceigenpy::internal::contains_vector_derived_policies< Container, NoProxy > | |
| ►Cwrapper | |
| CDataWrapper | |
| Cmodify_block_wrap | |
| CVirtualClassWrapper | Wrapper classes |
| CX_wrapper | |
| ►CX | |
| CX_wrapper | |
| ►Cmodify_block | |
| Cmodify_block_wrap | |