Classes | Typedefs | Enumerations | Functions | Variables
Eigen::internal Namespace Reference

Classes

struct  abs_knowing_score
 
struct  abs_knowing_score< Scalar, typename scalar_score_coeff_op< Scalar >::Score_is_abs >
 
struct  accessors_level
 
struct  add_assign_op
 
struct  add_const
 
struct  add_const< T & >
 
struct  add_const_on_value_type
 
struct  add_const_on_value_type< T & >
 
struct  add_const_on_value_type< T * >
 
struct  add_const_on_value_type< T *const >
 
struct  add_const_on_value_type< T const *const >
 
struct  add_const_on_value_type_if_arithmetic
 
class  aligned_stack_memory_handler
 
struct  all_unroller
 
struct  all_unroller< Derived, 0 >
 
struct  all_unroller< Derived, Dynamic >
 
class  AmbiVector
 
struct  any_unroller
 
struct  any_unroller< Derived, 0 >
 
struct  any_unroller< Derived, Dynamic >
 
struct  assign_op
 
struct  assign_op< DstScalar, void >
 
struct  Assignment
 
struct  Assignment< DstXprType, CwiseBinaryOp< internal::scalar_product_op< ScalarBis, Scalar >, const CwiseNullaryOp< internal::scalar_constant_op< ScalarBis >, Plain >, const Product< Lhs, Rhs, DefaultProduct > >, AssignFunc, Dense2Dense >
 
struct  Assignment< DstXprType, Homogeneous< ArgType, Horizontal >, internal::assign_op< Scalar, typename ArgType::Scalar >, Dense2Dense >
 
struct  Assignment< DstXprType, Homogeneous< ArgType, Vertical >, internal::assign_op< Scalar, typename ArgType::Scalar >, Dense2Dense >
 
struct  Assignment< DstXprType, Inverse< ColPivHouseholderQR< MatrixType > >, internal::assign_op< typename DstXprType::Scalar, typename ColPivHouseholderQR< MatrixType >::Scalar >, Dense2Dense >
 
struct  Assignment< DstXprType, Inverse< CompleteOrthogonalDecomposition< MatrixType > >, internal::assign_op< typename DstXprType::Scalar, typename CompleteOrthogonalDecomposition< MatrixType >::Scalar >, Dense2Dense >
 
struct  Assignment< DstXprType, Inverse< FullPivHouseholderQR< MatrixType > >, internal::assign_op< typename DstXprType::Scalar, typename FullPivHouseholderQR< MatrixType >::Scalar >, Dense2Dense >
 
struct  Assignment< DstXprType, Inverse< FullPivLU< MatrixType > >, internal::assign_op< typename DstXprType::Scalar, typename FullPivLU< MatrixType >::Scalar >, Dense2Dense >
 
struct  Assignment< DstXprType, Inverse< PartialPivLU< MatrixType > >, internal::assign_op< typename DstXprType::Scalar, typename PartialPivLU< MatrixType >::Scalar >, Dense2Dense >
 
struct  Assignment< DstXprType, Inverse< XprType >, internal::assign_op< typename DstXprType::Scalar, typename XprType::Scalar >, Dense2Dense >
 
struct  Assignment< DstXprType, Product< Lhs, Rhs, AliasFreeProduct >, internal::add_assign_op< typename DstXprType::Scalar, typename Product< Lhs, Rhs, AliasFreeProduct >::Scalar >, Sparse2Dense >
 
struct  Assignment< DstXprType, Product< Lhs, Rhs, AliasFreeProduct >, internal::assign_op< typename DstXprType::Scalar, typename Product< Lhs, Rhs, AliasFreeProduct >::Scalar >, Sparse2Dense >
 
struct  Assignment< DstXprType, Product< Lhs, Rhs, AliasFreeProduct >, internal::sub_assign_op< typename DstXprType::Scalar, typename Product< Lhs, Rhs, AliasFreeProduct >::Scalar >, Sparse2Dense >
 
struct  Assignment< DstXprType, Product< Lhs, Rhs, DefaultProduct >, internal::add_assign_op< Scalar, typename Product< Lhs, Rhs, DefaultProduct >::Scalar >, Dense2Triangular >
 
struct  Assignment< DstXprType, Product< Lhs, Rhs, DefaultProduct >, internal::assign_op< Scalar, typename Product< Lhs, Rhs, DefaultProduct >::Scalar >, Dense2Triangular >
 
struct  Assignment< DstXprType, Product< Lhs, Rhs, DefaultProduct >, internal::sub_assign_op< Scalar, typename Product< Lhs, Rhs, DefaultProduct >::Scalar >, Dense2Triangular >
 
struct  Assignment< DstXprType, Product< Lhs, Rhs, Options >, internal::add_assign_op< Scalar, Scalar >, Dense2Dense, typename enable_if<(Options==DefaultProduct||Options==AliasFreeProduct)>::type >
 
struct  Assignment< DstXprType, Product< Lhs, Rhs, Options >, internal::assign_op< Scalar, Scalar >, Dense2Dense, typename enable_if<(Options==DefaultProduct||Options==AliasFreeProduct)>::type >
 
struct  Assignment< DstXprType, Product< Lhs, Rhs, Options >, internal::sub_assign_op< Scalar, Scalar >, Dense2Dense, typename enable_if<(Options==DefaultProduct||Options==AliasFreeProduct)>::type >
 
struct  Assignment< DstXprType, Solve< CwiseUnaryOp< internal::scalar_conjugate_op< typename DecType::Scalar >, const Transpose< const DecType > >, RhsType >, internal::assign_op< Scalar, Scalar >, Dense2Dense >
 
struct  Assignment< DstXprType, Solve< DecType, RhsType >, internal::assign_op< Scalar, Scalar >, Dense2Dense >
 
struct  Assignment< DstXprType, Solve< DecType, RhsType >, internal::assign_op< Scalar, Scalar >, Sparse2Sparse >
 
struct  Assignment< DstXprType, Solve< Transpose< const DecType >, RhsType >, internal::assign_op< Scalar, Scalar >, Dense2Dense >
 
struct  Assignment< DstXprType, SolveWithGuess< DecType, RhsType, GuessType >, internal::assign_op< Scalar, Scalar >, Dense2Dense >
 
struct  Assignment< DstXprType, SparseQRMatrixQReturnType< SparseQRType >, internal::assign_op< typename DstXprType::Scalar, typename DstXprType::Scalar >, Sparse2Dense >
 
struct  Assignment< DstXprType, SparseQRMatrixQReturnType< SparseQRType >, internal::assign_op< typename DstXprType::Scalar, typename DstXprType::Scalar >, Sparse2Sparse >
 
struct  Assignment< DstXprType, SparseSymmetricPermutationProduct< MatrixType, Mode >, internal::assign_op< Scalar, typename MatrixType::Scalar >, Sparse2Sparse >
 
struct  Assignment< DstXprType, SrcXprType, Functor, Dense2Dense, Weak >
 
struct  Assignment< DstXprType, SrcXprType, Functor, Dense2Triangular >
 
struct  Assignment< DstXprType, SrcXprType, Functor, Diagonal2Dense >
 
struct  Assignment< DstXprType, SrcXprType, Functor, Diagonal2Sparse >
 
struct  Assignment< DstXprType, SrcXprType, Functor, EigenBase2EigenBase, Weak >
 
struct  Assignment< DstXprType, SrcXprType, Functor, Sparse2Dense >
 
struct  Assignment< DstXprType, SrcXprType, Functor, Sparse2Sparse >
 
struct  Assignment< DstXprType, SrcXprType, Functor, SparseSelfAdjoint2Sparse >
 
struct  Assignment< DstXprType, SrcXprType, Functor, Triangular2Dense >
 
struct  Assignment< DstXprType, SrcXprType, Functor, Triangular2Triangular >
 
struct  assignment_from_xpr_op_product
 
struct  AssignmentKind
 
struct  AssignmentKind< DenseShape, BandShape >
 
struct  AssignmentKind< DenseShape, DenseShape >
 
struct  AssignmentKind< DenseShape, DiagonalShape >
 
struct  AssignmentKind< DenseShape, HomogeneousShape >
 
struct  AssignmentKind< DenseShape, PermutationShape >
 
struct  AssignmentKind< DenseShape, SparseShape >
 
struct  AssignmentKind< DenseShape, SparseTriangularShape >
 
struct  AssignmentKind< DenseShape, TriangularShape >
 
struct  AssignmentKind< SparseSelfAdjointShape, SparseShape >
 
struct  AssignmentKind< SparseShape, DiagonalShape >
 
struct  AssignmentKind< SparseShape, SparseSelfAdjointShape >
 
struct  AssignmentKind< SparseShape, SparseShape >
 
struct  AssignmentKind< SparseShape, SparseTriangularShape >
 
struct  AssignmentKind< TriangularShape, DenseShape >
 
struct  AssignmentKind< TriangularShape, TriangularShape >
 
class  BandMatrix
 Represents a rectangular matrix with a banded storage. More...
 
class  BandMatrixBase
 
class  BandMatrixWrapper
 
struct  BandShape
 
struct  binary_evaluator
 
struct  binary_evaluator< CwiseBinaryOp< BinaryOp, Lhs, Rhs >, IndexBased, IndexBased >
 
struct  binary_evaluator< CwiseBinaryOp< BinaryOp, Lhs, Rhs >, IndexBased, IteratorBased >
 
struct  binary_evaluator< CwiseBinaryOp< BinaryOp, Lhs, Rhs >, IteratorBased, IndexBased >
 
struct  binary_evaluator< CwiseBinaryOp< BinaryOp, Lhs, Rhs >, IteratorBased, IteratorBased >
 
struct  binary_evaluator< CwiseBinaryOp< scalar_boolean_and_op, Lhs, Rhs >, IndexBased, IteratorBased >
 
struct  binary_evaluator< CwiseBinaryOp< scalar_boolean_and_op, Lhs, Rhs >, IteratorBased, IndexBased >
 
struct  binary_evaluator< CwiseBinaryOp< scalar_boolean_and_op, Lhs, Rhs >, IteratorBased, IteratorBased >
 
struct  binary_evaluator< CwiseBinaryOp< scalar_product_op< T1, T2 >, Lhs, Rhs >, IndexBased, IteratorBased >
 
struct  binary_evaluator< CwiseBinaryOp< scalar_product_op< T1, T2 >, Lhs, Rhs >, IteratorBased, IndexBased >
 
struct  binary_evaluator< CwiseBinaryOp< scalar_product_op< T1, T2 >, Lhs, Rhs >, IteratorBased, IteratorBased >
 
struct  binary_op_base
 
struct  binary_result_of_select
 
struct  binary_result_of_select< Func, ArgType0, ArgType1, sizeof(has_std_result_type)>
 
struct  binary_result_of_select< Func, ArgType0, ArgType1, sizeof(has_tr1_result)>
 
struct  binary_sparse_evaluator
 
struct  bind1st_op
 
struct  bind2nd_op
 
class  blas_data_mapper
 
struct  blas_traits
 
struct  blas_traits< const T >
 
struct  blas_traits< CwiseBinaryOp< scalar_product_op< Scalar >, const CwiseNullaryOp< scalar_constant_op< Scalar >, Plain >, NestedXpr > >
 
struct  blas_traits< CwiseBinaryOp< scalar_product_op< Scalar >, const CwiseNullaryOp< scalar_constant_op< Scalar >, Plain1 >, const CwiseNullaryOp< scalar_constant_op< Scalar >, Plain2 > > >
 
struct  blas_traits< CwiseBinaryOp< scalar_product_op< Scalar >, NestedXpr, const CwiseNullaryOp< scalar_constant_op< Scalar >, Plain > > >
 
struct  blas_traits< CwiseUnaryOp< scalar_conjugate_op< Scalar >, NestedXpr > >
 
struct  blas_traits< CwiseUnaryOp< scalar_opposite_op< Scalar >, NestedXpr > >
 
struct  blas_traits< Transpose< NestedXpr > >
 
class  BlasLinearMapper
 
class  BlasVectorMapper
 
struct  block_evaluator
 
struct  block_evaluator< ArgType, BlockRows, BlockCols, InnerPanel, false >
 
struct  block_evaluator< ArgType, BlockRows, BlockCols, InnerPanel, true >
 
class  BlockImpl_dense
 
class  BlockImpl_dense< XprType, BlockRows, BlockCols, InnerPanel, true >
 
struct  CacheSizes
 
struct  cast_return_type
 
struct  check_rows_cols_for_overflow
 
struct  check_rows_cols_for_overflow< Dynamic >
 
struct  check_transpose_aliasing_compile_time_selector
 
struct  check_transpose_aliasing_compile_time_selector< DestIsTransposed, CwiseBinaryOp< BinOp, DerivedA, DerivedB > >
 
struct  check_transpose_aliasing_run_time_selector
 
struct  check_transpose_aliasing_run_time_selector< Scalar, DestIsTransposed, CwiseBinaryOp< BinOp, DerivedA, DerivedB > >
 
struct  checkTransposeAliasing_impl
 
struct  checkTransposeAliasing_impl< Derived, OtherDerived, false >
 
struct  cholmod_configure_matrix
 
struct  cholmod_configure_matrix< double >
 
struct  cholmod_configure_matrix< std::complex< double > >
 
struct  coeff_visitor
 
struct  colamd_col
 
struct  Colamd_Row
 
struct  column_dfs_traits
 
struct  complex_schur_reduce_to_hessenberg
 
struct  complex_schur_reduce_to_hessenberg< MatrixType, false >
 
class  CompressedStorage
 
struct  compute_default_alignment
 
struct  compute_default_alignment< T, Dynamic >
 
struct  compute_default_alignment_helper
 
struct  compute_inverse
 
struct  compute_inverse< MatrixType, ResultType, 1 >
 
struct  compute_inverse< MatrixType, ResultType, 2 >
 
struct  compute_inverse< MatrixType, ResultType, 3 >
 
struct  compute_inverse< MatrixType, ResultType, 4 >
 
struct  compute_inverse_and_det_with_check
 
struct  compute_inverse_and_det_with_check< MatrixType, ResultType, 1 >
 
struct  compute_inverse_and_det_with_check< MatrixType, ResultType, 2 >
 
struct  compute_inverse_and_det_with_check< MatrixType, ResultType, 3 >
 
struct  compute_inverse_and_det_with_check< MatrixType, ResultType, 4 >
 
struct  compute_inverse_size4
 
struct  compute_inverse_size4< Architecture::SSE, double, MatrixType, ResultType >
 
struct  compute_inverse_size4< Architecture::SSE, float, MatrixType, ResultType >
 
class  compute_matrix_flags
 
struct  conditional
 
struct  conditional< false, Then, Else >
 
struct  conj_expr_if
 
struct  conj_helper
 
struct  conj_helper< Packet1cd, Packet1cd, false, true >
 
struct  conj_helper< Packet1cd, Packet1cd, true, false >
 
struct  conj_helper< Packet1cd, Packet1cd, true, true >
 
struct  conj_helper< Packet1cd, Packet2d, false, false >
 
struct  conj_helper< Packet2cd, Packet2cd, false, true >
 
struct  conj_helper< Packet2cd, Packet2cd, true, false >
 
struct  conj_helper< Packet2cd, Packet2cd, true, true >
 
struct  conj_helper< Packet2cd, Packet4d, false, false >
 
struct  conj_helper< Packet2cf, Packet2cf, false, true >
 
struct  conj_helper< Packet2cf, Packet2cf, true, false >
 
struct  conj_helper< Packet2cf, Packet2cf, true, true >
 
struct  conj_helper< Packet2cf, Packet4f, false, false >
 
struct  conj_helper< Packet2d, Packet1cd, false, false >
 
struct  conj_helper< Packet4cf, Packet4cf, false, true >
 
struct  conj_helper< Packet4cf, Packet4cf, true, false >
 
struct  conj_helper< Packet4cf, Packet4cf, true, true >
 
struct  conj_helper< Packet4cf, Packet8f, false, false >
 
struct  conj_helper< Packet4d, Packet2cd, false, false >
 
struct  conj_helper< Packet4f, Packet2cf, false, false >
 
struct  conj_helper< Packet8f, Packet4cf, false, false >
 
struct  conj_helper< RealScalar, std::complex< RealScalar >, false, Conj >
 
struct  conj_helper< Scalar, Scalar, false, false >
 
struct  conj_helper< std::complex< RealScalar >, RealScalar, Conj, false >
 
struct  conj_helper< std::complex< RealScalar >, std::complex< RealScalar >, false, true >
 
struct  conj_helper< std::complex< RealScalar >, std::complex< RealScalar >, true, false >
 
struct  conj_helper< std::complex< RealScalar >, std::complex< RealScalar >, true, true >
 
struct  conj_if
 
struct  conj_if< false >
 
struct  conj_if< true >
 
struct  conservative_resize_like_impl
 
struct  conservative_resize_like_impl< Derived, OtherDerived, true >
 
struct  conservative_sparse_sparse_product_selector
 
struct  conservative_sparse_sparse_product_selector< Lhs, Rhs, ResultType, ColMajor, ColMajor, ColMajor >
 
struct  conservative_sparse_sparse_product_selector< Lhs, Rhs, ResultType, ColMajor, ColMajor, RowMajor >
 
struct  conservative_sparse_sparse_product_selector< Lhs, Rhs, ResultType, ColMajor, RowMajor, ColMajor >
 
struct  conservative_sparse_sparse_product_selector< Lhs, Rhs, ResultType, ColMajor, RowMajor, RowMajor >
 
struct  conservative_sparse_sparse_product_selector< Lhs, Rhs, ResultType, RowMajor, ColMajor, ColMajor >
 
struct  conservative_sparse_sparse_product_selector< Lhs, Rhs, ResultType, RowMajor, ColMajor, RowMajor >
 
struct  conservative_sparse_sparse_product_selector< Lhs, Rhs, ResultType, RowMajor, RowMajor, ColMajor >
 
struct  conservative_sparse_sparse_product_selector< Lhs, Rhs, ResultType, RowMajor, RowMajor, RowMajor >
 
class  const_blas_data_mapper
 
struct  constructor_without_unaligned_array_assert
 
struct  copy_using_evaluator_DefaultTraversal_CompleteUnrolling
 
struct  copy_using_evaluator_DefaultTraversal_CompleteUnrolling< Kernel, Stop, Stop >
 
struct  copy_using_evaluator_DefaultTraversal_InnerUnrolling
 
struct  copy_using_evaluator_DefaultTraversal_InnerUnrolling< Kernel, Stop, Stop >
 
struct  copy_using_evaluator_innervec_CompleteUnrolling
 
struct  copy_using_evaluator_innervec_CompleteUnrolling< Kernel, Stop, Stop >
 
struct  copy_using_evaluator_innervec_InnerUnrolling
 
struct  copy_using_evaluator_innervec_InnerUnrolling< Kernel, Stop, Stop, SrcAlignment, DstAlignment >
 
struct  copy_using_evaluator_LinearTraversal_CompleteUnrolling
 
struct  copy_using_evaluator_LinearTraversal_CompleteUnrolling< Kernel, Stop, Stop >
 
struct  copy_using_evaluator_traits
 
struct  cross3_impl
 
struct  cross3_impl< Architecture::SSE, VectorLhs, VectorRhs, float, true >
 
struct  cwise_promote_storage_type
 
struct  cwise_promote_storage_type< A, A, Functor >
 
struct  cwise_promote_storage_type< A, Dense, Functor >
 
struct  cwise_promote_storage_type< Dense, B, Functor >
 
struct  cwise_promote_storage_type< Dense, Dense, Functor >
 
struct  cwise_promote_storage_type< Dense, Sparse, Functor >
 
struct  cwise_promote_storage_type< Sparse, Dense, Functor >
 
struct  decrement_size
 
struct  default_digits10_impl
 
struct  default_digits10_impl< T, false, false >
 
struct  default_digits10_impl< T, false, true >
 
struct  default_packet_traits
 
struct  Dense2Dense
 
struct  Dense2Triangular
 
struct  dense_assignment_loop
 
struct  dense_assignment_loop< Kernel, DefaultTraversal, CompleteUnrolling >
 
struct  dense_assignment_loop< Kernel, DefaultTraversal, InnerUnrolling >
 
struct  dense_assignment_loop< Kernel, DefaultTraversal, NoUnrolling >
 
struct  dense_assignment_loop< Kernel, InnerVectorizedTraversal, CompleteUnrolling >
 
struct  dense_assignment_loop< Kernel, InnerVectorizedTraversal, InnerUnrolling >
 
struct  dense_assignment_loop< Kernel, InnerVectorizedTraversal, NoUnrolling >
 
struct  dense_assignment_loop< Kernel, LinearTraversal, CompleteUnrolling >
 
struct  dense_assignment_loop< Kernel, LinearTraversal, NoUnrolling >
 
struct  dense_assignment_loop< Kernel, LinearVectorizedTraversal, CompleteUnrolling >
 
struct  dense_assignment_loop< Kernel, LinearVectorizedTraversal, NoUnrolling >
 
struct  dense_assignment_loop< Kernel, SliceVectorizedTraversal, NoUnrolling >
 
class  dense_product_base
 
class  dense_product_base< Lhs, Rhs, Option, InnerProduct >
 
struct  dense_xpr_base
 
struct  dense_xpr_base< Derived, ArrayXpr >
 
struct  dense_xpr_base< Derived, MatrixXpr >
 
struct  determinant_impl
 
struct  determinant_impl< Derived, 1 >
 
struct  determinant_impl< Derived, 2 >
 
struct  determinant_impl< Derived, 3 >
 
struct  determinant_impl< Derived, 4 >
 
struct  Diagonal2Dense
 
struct  Diagonal2Sparse
 
struct  diagonal_product_evaluator_base
 
struct  direct_selfadjoint_eigenvalues
 
struct  direct_selfadjoint_eigenvalues< SolverType, 2, false >
 
struct  direct_selfadjoint_eigenvalues< SolverType, 3, false >
 
struct  div_assign_op
 
struct  dot_nocheck
 
struct  dot_nocheck< T, U, true >
 
struct  DoublePacket
 
struct  EigenBase2EigenBase
 
struct  eigenvalues_selector
 
struct  eigenvalues_selector< Derived, false >
 
struct  enable_if
 
struct  enable_if< true, T >
 
struct  enable_if_ref
 
struct  enable_if_ref< Ref< T >, Derived >
 
struct  EnableIf
 
struct  etor_product_coeff_impl
 
struct  etor_product_packet_impl
 
struct  etor_product_packet_impl< ColMajor, 0, Lhs, Rhs, Packet, LoadMode >
 
struct  etor_product_packet_impl< ColMajor, 1, Lhs, Rhs, Packet, LoadMode >
 
struct  etor_product_packet_impl< ColMajor, Dynamic, Lhs, Rhs, Packet, LoadMode >
 
struct  etor_product_packet_impl< ColMajor, UnrollingIndex, Lhs, Rhs, Packet, LoadMode >
 
struct  etor_product_packet_impl< RowMajor, 0, Lhs, Rhs, Packet, LoadMode >
 
struct  etor_product_packet_impl< RowMajor, 1, Lhs, Rhs, Packet, LoadMode >
 
struct  etor_product_packet_impl< RowMajor, Dynamic, Lhs, Rhs, Packet, LoadMode >
 
struct  etor_product_packet_impl< RowMajor, UnrollingIndex, Lhs, Rhs, Packet, LoadMode >
 
struct  eval
 
struct  eval< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Dense >
 
struct  eval< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Dense >
 
struct  eval< T, Dense >
 
struct  eval< T, DiagonalShape >
 
struct  eval< T, Sparse >
 
class  EvalToTemp
 
struct  evaluator
 
struct  evaluator< Array< Scalar, Rows, Cols, Options, MaxRows, MaxCols > >
 
struct  evaluator< Block< ArgType, BlockRows, BlockCols, InnerPanel > >
 
struct  evaluator< const T >
 
struct  evaluator< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >
 
struct  evaluator< CwiseBinaryOp< internal::scalar_product_op< Scalar1, Scalar2 >, const CwiseNullaryOp< internal::scalar_constant_op< Scalar1 >, Plain1 >, const Product< Lhs, Rhs, DefaultProduct > > >
 
struct  evaluator< CwiseNullaryOp< NullaryOp, PlainObjectType > >
 
struct  evaluator< CwiseTernaryOp< TernaryOp, Arg1, Arg2, Arg3 > >
 
struct  evaluator< Diagonal< ArgType, DiagIndex > >
 
struct  evaluator< Diagonal< const Product< Lhs, Rhs, DefaultProduct >, DiagIndex > >
 
struct  evaluator< EvalToTemp< ArgType > >
 
struct  evaluator< Map< const SparseMatrix< MatScalar, MatOptions, MatIndex >, Options, StrideType > >
 
struct  evaluator< Map< PlainObjectType, MapOptions, StrideType > >
 
struct  evaluator< Map< SparseMatrix< MatScalar, MatOptions, MatIndex >, Options, StrideType > >
 
struct  evaluator< MappedSparseMatrix< _Scalar, _Options, _StorageIndex > >
 
struct  evaluator< Matrix< Scalar, Rows, Cols, Options, MaxRows, MaxCols > >
 
struct  evaluator< PartialReduxExpr< ArgType, MemberOp, Direction > >
 
struct  evaluator< PlainObjectBase< Derived > >
 
struct  evaluator< Product< Lhs, Rhs, Options > >
 
struct  evaluator< Ref< const SparseMatrix< MatScalar, MatOptions, MatIndex >, Options, StrideType > >
 
struct  evaluator< Ref< const SparseVector< MatScalar, MatOptions, MatIndex >, Options, StrideType > >
 
struct  evaluator< Ref< PlainObjectType, RefOptions, StrideType > >
 
struct  evaluator< Ref< SparseMatrix< MatScalar, MatOptions, MatIndex >, Options, StrideType > >
 
struct  evaluator< Ref< SparseVector< MatScalar, MatOptions, MatIndex >, Options, StrideType > >
 
struct  evaluator< ReturnByValue< Derived > >
 
struct  evaluator< Select< ConditionMatrixType, ThenMatrixType, ElseMatrixType > >
 
struct  evaluator< Solve< Decomposition, RhsType > >
 
struct  evaluator< SolveWithGuess< Decomposition, RhsType, GuessType > >
 
struct  evaluator< SparseCompressedBase< Derived > >
 
struct  evaluator< SparseMatrix< _Scalar, _Options, _Index > >
 
struct  evaluator< SparseVector< _Scalar, _Options, _Index > >
 
struct  evaluator_assume_aliasing
 
struct  evaluator_assume_aliasing< CwiseBinaryOp< internal::scalar_product_op< Scalar1, Scalar2 >, const CwiseNullaryOp< internal::scalar_constant_op< Scalar1 >, Plain1 >, const Product< Lhs, Rhs, DefaultProduct > > >
 
struct  evaluator_assume_aliasing< CwiseBinaryOp< internal::scalar_sum_op< typename OtherXpr::Scalar, typename Product< Lhs, Rhs, DefaultProduct >::Scalar >, const OtherXpr, const Product< Lhs, Rhs, DefaultProduct > >, DenseShape >
 
struct  evaluator_assume_aliasing< Product< Lhs, Rhs, DefaultProduct > >
 
struct  evaluator_base
 
struct  evaluator_traits
 
struct  evaluator_traits< BandMatrix< _Scalar, _Rows, _Cols, _Supers, _Subs, _Options > >
 
struct  evaluator_traits< BandMatrixWrapper< _CoefficientsType, _Rows, _Cols, _Supers, _Subs, _Options > >
 
struct  evaluator_traits< Homogeneous< ArgType, Direction > >
 
struct  evaluator_traits< HouseholderSequence< VectorsType, CoeffsType, Side > >
 
struct  evaluator_traits< SelfAdjointView< MatrixType, Mode > >
 
struct  evaluator_traits< SparseQRMatrixQReturnType< SparseQRType > >
 
struct  evaluator_traits< SparseSelfAdjointView< MatrixType, Mode > >
 
struct  evaluator_traits< TriangularView< MatrixType, Mode > >
 
struct  evaluator_traits_base
 
struct  evaluator_wrapper_base
 
struct  extract_data_selector
 
struct  extract_data_selector< T, false >
 
struct  false_type
 
struct  find_best_packet
 
struct  find_best_packet_helper
 
struct  find_best_packet_helper< Size, PacketType, false >
 
struct  find_best_packet_helper< Size, PacketType, true >
 
struct  first_aligned_impl
 
struct  first_aligned_impl< Alignment, Derived, false >
 
struct  FullPivHouseholderQRMatrixQReturnType
 Expression type for return value of FullPivHouseholderQR::matrixQ() More...
 
struct  functor_has_linear_access
 
struct  functor_traits
 
struct  functor_traits< add_assign_op< DstScalar, SrcScalar > >
 
struct  functor_traits< assign_op< DstScalar, SrcScalar > >
 
struct  functor_traits< bind1st_op< BinaryOp > >
 
struct  functor_traits< bind2nd_op< BinaryOp > >
 
struct  functor_traits< div_assign_op< DstScalar, SrcScalar > >
 
struct  functor_traits< linspaced_op< Scalar, PacketType > >
 
struct  functor_traits< max_coeff_visitor< Scalar > >
 
struct  functor_traits< min_coeff_visitor< Scalar > >
 
struct  functor_traits< mul_assign_op< DstScalar, SrcScalar > >
 
struct  functor_traits< scalar_abs2_op< Scalar > >
 
struct  functor_traits< scalar_abs_op< Scalar > >
 
struct  functor_traits< scalar_acos_op< Scalar > >
 
struct  functor_traits< scalar_arg_op< Scalar > >
 
struct  functor_traits< scalar_asin_op< Scalar > >
 
struct  functor_traits< scalar_atan_op< Scalar > >
 
struct  functor_traits< scalar_boolean_and_op >
 
struct  functor_traits< scalar_boolean_not_op< Scalar > >
 
struct  functor_traits< scalar_boolean_or_op >
 
struct  functor_traits< scalar_boolean_xor_op >
 
struct  functor_traits< scalar_cast_op< Eigen::half, float > >
 
struct  functor_traits< scalar_cast_op< float, Eigen::half > >
 
struct  functor_traits< scalar_cast_op< int, Eigen::half > >
 
struct  functor_traits< scalar_cast_op< Scalar, NewType > >
 
struct  functor_traits< scalar_ceil_op< Scalar > >
 
struct  functor_traits< scalar_cmp_op< LhsScalar, RhsScalar, cmp > >
 
struct  functor_traits< scalar_conj_product_op< LhsScalar, RhsScalar > >
 
struct  functor_traits< scalar_conjugate_op< Scalar > >
 
struct  functor_traits< scalar_constant_op< Scalar > >
 
struct  functor_traits< scalar_cos_op< Scalar > >
 
struct  functor_traits< scalar_cosh_op< Scalar > >
 
struct  functor_traits< scalar_cube_op< Scalar > >
 
struct  functor_traits< scalar_difference_op< LhsScalar, RhsScalar > >
 
struct  functor_traits< scalar_exp_op< Scalar > >
 
struct  functor_traits< scalar_floor_op< Scalar > >
 
struct  functor_traits< scalar_hypot_op< Scalar, Scalar > >
 
struct  functor_traits< scalar_identity_op< Scalar > >
 
struct  functor_traits< scalar_imag_op< Scalar > >
 
struct  functor_traits< scalar_imag_ref_op< Scalar > >
 
struct  functor_traits< scalar_inverse_op< Scalar > >
 
struct  functor_traits< scalar_isfinite_op< Scalar > >
 
struct  functor_traits< scalar_isinf_op< Scalar > >
 
struct  functor_traits< scalar_isnan_op< Scalar > >
 
struct  functor_traits< scalar_log10_op< Scalar > >
 
struct  functor_traits< scalar_log1p_op< Scalar > >
 
struct  functor_traits< scalar_log_op< Scalar > >
 
struct  functor_traits< scalar_max_op< LhsScalar, RhsScalar > >
 
struct  functor_traits< scalar_min_op< LhsScalar, RhsScalar > >
 
struct  functor_traits< scalar_opposite_op< Scalar > >
 
struct  functor_traits< scalar_pow_op< Scalar, Exponent > >
 
struct  functor_traits< scalar_product_op< LhsScalar, RhsScalar > >
 
struct  functor_traits< scalar_quotient_op< LhsScalar, RhsScalar > >
 
struct  functor_traits< scalar_random_op< Scalar > >
 
struct  functor_traits< scalar_real_op< Scalar > >
 
struct  functor_traits< scalar_real_ref_op< Scalar > >
 
struct  functor_traits< scalar_round_op< Scalar > >
 
struct  functor_traits< scalar_rsqrt_op< Scalar > >
 
struct  functor_traits< scalar_score_coeff_op< Scalar > >
 
struct  functor_traits< scalar_sign_op< Scalar > >
 
struct  functor_traits< scalar_sin_op< Scalar > >
 
struct  functor_traits< scalar_sinh_op< Scalar > >
 
struct  functor_traits< scalar_sqrt_op< Scalar > >
 
struct  functor_traits< scalar_square_op< Scalar > >
 
struct  functor_traits< scalar_sum_op< LhsScalar, RhsScalar > >
 
struct  functor_traits< scalar_tan_op< Scalar > >
 
struct  functor_traits< scalar_tanh_op< Scalar > >
 
struct  functor_traits< std::binary_negate< T > >
 
struct  functor_traits< std::binder1st< T > >
 
struct  functor_traits< std::binder2nd< T > >
 
struct  functor_traits< std::divides< T > >
 
struct  functor_traits< std::equal_to< T > >
 
struct  functor_traits< std::greater< T > >
 
struct  functor_traits< std::greater_equal< T > >
 
struct  functor_traits< std::less< T > >
 
struct  functor_traits< std::less_equal< T > >
 
struct  functor_traits< std::logical_and< T > >
 
struct  functor_traits< std::logical_not< T > >
 
struct  functor_traits< std::logical_or< T > >
 
struct  functor_traits< std::minus< T > >
 
struct  functor_traits< std::multiplies< T > >
 
struct  functor_traits< std::negate< T > >
 
struct  functor_traits< std::not_equal_to< T > >
 
struct  functor_traits< std::plus< T > >
 
struct  functor_traits< std::unary_negate< T > >
 
struct  functor_traits< sub_assign_op< DstScalar, SrcScalar > >
 
struct  functor_traits< swap_assign_op< Scalar > >
 
struct  gebp_kernel
 
struct  gebp_madd_selector
 
struct  gebp_madd_selector< CJ, T, T, T, T >
 
class  gebp_traits
 
class  gebp_traits< RealScalar, std::complex< RealScalar >, false, _ConjRhs >
 
class  gebp_traits< std::complex< RealScalar >, RealScalar, _ConjLhs, false >
 
class  gebp_traits< std::complex< RealScalar >, std::complex< RealScalar >, _ConjLhs, _ConjRhs >
 
class  gemm_blocking_space
 
class  gemm_blocking_space< StorageOrder, _LhsScalar, _RhsScalar, MaxRows, MaxCols, MaxDepth, KcFactor, false >
 
class  gemm_blocking_space< StorageOrder, _LhsScalar, _RhsScalar, MaxRows, MaxCols, MaxDepth, KcFactor, true >
 
struct  gemm_functor
 
struct  gemm_pack_lhs
 
struct  gemm_pack_lhs< Scalar, Index, DataMapper, Pack1, Pack2, ColMajor, Conjugate, PanelMode >
 
struct  gemm_pack_lhs< Scalar, Index, DataMapper, Pack1, Pack2, RowMajor, Conjugate, PanelMode >
 
struct  gemm_pack_rhs
 
struct  gemm_pack_rhs< Scalar, Index, DataMapper, nr, ColMajor, Conjugate, PanelMode >
 
struct  gemm_pack_rhs< Scalar, Index, DataMapper, nr, RowMajor, Conjugate, PanelMode >
 
struct  GemmParallelInfo
 
struct  gemv_dense_selector
 
struct  gemv_dense_selector< OnTheLeft, StorageOrder, BlasCompatible >
 
struct  gemv_dense_selector< OnTheRight, ColMajor, false >
 
struct  gemv_dense_selector< OnTheRight, ColMajor, true >
 
struct  gemv_dense_selector< OnTheRight, RowMajor, false >
 
struct  gemv_dense_selector< OnTheRight, RowMajor, true >
 
struct  gemv_static_vector_if
 
struct  gemv_static_vector_if< Scalar, Size, Dynamic, true >
 
struct  gemv_static_vector_if< Scalar, Size, MaxSize, false >
 
struct  gemv_static_vector_if< Scalar, Size, MaxSize, true >
 
struct  general_matrix_matrix_product
 
struct  general_matrix_matrix_product< Index, LhsScalar, LhsStorageOrder, ConjugateLhs, RhsScalar, RhsStorageOrder, ConjugateRhs, ColMajor >
 
struct  general_matrix_matrix_product< Index, LhsScalar, LhsStorageOrder, ConjugateLhs, RhsScalar, RhsStorageOrder, ConjugateRhs, RowMajor >
 
struct  general_matrix_matrix_rankupdate
 
struct  general_matrix_matrix_triangular_product
 
struct  general_matrix_matrix_triangular_product< Index, LhsScalar, LhsStorageOrder, ConjugateLhs, RhsScalar, RhsStorageOrder, ConjugateRhs, ColMajor, UpLo, Version >
 
struct  general_matrix_matrix_triangular_product< Index, LhsScalar, LhsStorageOrder, ConjugateLhs, RhsScalar, RhsStorageOrder, ConjugateRhs, RowMajor, UpLo, Version >
 
struct  general_matrix_vector_product
 
struct  general_matrix_vector_product< Index, LhsScalar, LhsMapper, ColMajor, ConjugateLhs, RhsScalar, RhsMapper, ConjugateRhs, Version >
 
struct  general_matrix_vector_product< Index, LhsScalar, LhsMapper, RowMajor, ConjugateLhs, RhsScalar, RhsMapper, ConjugateRhs, Version >
 
struct  general_matrix_vector_product_gemv
 
class  generic_dense_assignment_kernel
 
class  generic_dense_assignment_kernel< DstEvaluatorTypeT, SrcEvaluatorTypeT, swap_assign_op< typename DstEvaluatorTypeT::Scalar >, Specialized >
 
class  generic_matrix_wrapper
 
class  generic_matrix_wrapper< MatrixType, false >
 
class  generic_matrix_wrapper< MatrixType, true >
 
struct  generic_product_impl
 
struct  generic_product_impl< Homogeneous< LhsArg, Horizontal >, Rhs, HomogeneousShape, DenseShape, ProductTag >
 
struct  generic_product_impl< Inverse< Lhs >, Rhs, PermutationShape, MatrixShape, ProductTag >
 
struct  generic_product_impl< Lhs, Homogeneous< RhsArg, Vertical >, DenseShape, HomogeneousShape, ProductTag >
 
struct  generic_product_impl< Lhs, Homogeneous< RhsArg, Vertical >, TriangularShape, HomogeneousShape, ProductTag >
 
struct  generic_product_impl< Lhs, Inverse< Rhs >, MatrixShape, PermutationShape, ProductTag >
 
struct  generic_product_impl< Lhs, Rhs, DenseShape, DenseShape, CoeffBasedProductMode >
 
struct  generic_product_impl< Lhs, Rhs, DenseShape, DenseShape, GemmProduct >
 
struct  generic_product_impl< Lhs, Rhs, DenseShape, DenseShape, GemvProduct >
 
struct  generic_product_impl< Lhs, Rhs, DenseShape, DenseShape, InnerProduct >
 
struct  generic_product_impl< Lhs, Rhs, DenseShape, DenseShape, LazyCoeffBasedProductMode >
 
struct  generic_product_impl< Lhs, Rhs, DenseShape, DenseShape, OuterProduct >
 
struct  generic_product_impl< Lhs, Rhs, DenseShape, SelfAdjointShape, ProductTag >
 
struct  generic_product_impl< Lhs, Rhs, DenseShape, SparseShape, ProductType >
 
struct  generic_product_impl< Lhs, Rhs, DenseShape, SparseTriangularShape, ProductType >
 
struct  generic_product_impl< Lhs, Rhs, DenseShape, TriangularShape, ProductTag >
 
struct  generic_product_impl< Lhs, Rhs, MatrixShape, PermutationShape, ProductTag >
 
struct  generic_product_impl< Lhs, Rhs, MatrixShape, TranspositionsShape, ProductTag >
 
struct  generic_product_impl< Lhs, Rhs, PermutationShape, MatrixShape, ProductTag >
 
struct  generic_product_impl< Lhs, Rhs, SelfAdjointShape, DenseShape, ProductTag >
 
struct  generic_product_impl< Lhs, Rhs, SparseShape, DenseShape, ProductType >
 
struct  generic_product_impl< Lhs, Rhs, SparseShape, SparseShape, ProductType >
 
struct  generic_product_impl< Lhs, Rhs, SparseShape, SparseTriangularShape, ProductType >
 
struct  generic_product_impl< Lhs, Rhs, SparseTriangularShape, DenseShape, ProductType >
 
struct  generic_product_impl< Lhs, Rhs, SparseTriangularShape, SparseShape, ProductType >
 
struct  generic_product_impl< Lhs, Rhs, TranspositionsShape, MatrixShape, ProductTag >
 
struct  generic_product_impl< Lhs, Rhs, TriangularShape, DenseShape, ProductTag >
 
struct  generic_product_impl< Lhs, RhsView, DenseShape, SparseSelfAdjointShape, ProductType >
 
struct  generic_product_impl< Lhs, Transpose< Rhs >, MatrixShape, TranspositionsShape, ProductTag >
 
struct  generic_product_impl< LhsView, Rhs, SparseSelfAdjointShape, DenseShape, ProductType >
 
struct  generic_product_impl< Transform< Scalar, Dim, Mode, Options >, Homogeneous< RhsArg, Vertical >, DenseShape, HomogeneousShape, ProductTag >
 
struct  generic_product_impl< Transpose< Lhs >, Rhs, TranspositionsShape, MatrixShape, ProductTag >
 
struct  generic_product_impl_base
 
struct  generic_xpr_base
 
struct  generic_xpr_base< Derived, MatrixXpr, SolverStorage >
 
struct  generic_xpr_base< Derived, MatrixXpr, Sparse >
 
struct  generic_xpr_base< Derived, XprKind, Dense >
 
struct  get_factor
 
struct  get_factor< Scalar, typename NumTraits< Scalar >::Real >
 
struct  glue_shapes
 
struct  glue_shapes< DenseShape, TriangularShape >
 
struct  glue_shapes< SparseShape, SelfAdjointShape >
 
struct  glue_shapes< SparseShape, TriangularShape >
 
struct  has_binary_operator
 
struct  has_binary_operator< linspaced_op< Scalar, PacketType >, IndexType >
 
struct  has_binary_operator< scalar_constant_op< Scalar >, IndexType >
 
struct  has_binary_operator< scalar_identity_op< Scalar >, IndexType >
 
struct  has_binary_operator< scalar_random_op< Scalar >, IndexType >
 
struct  has_direct_access
 
struct  has_none
 
struct  has_nullary_operator
 
struct  has_nullary_operator< linspaced_op< Scalar, PacketType >, IndexType >
 
struct  has_nullary_operator< scalar_constant_op< Scalar >, IndexType >
 
struct  has_nullary_operator< scalar_identity_op< Scalar >, IndexType >
 
struct  has_nullary_operator< scalar_random_op< Scalar >, IndexType >
 
struct  has_ReturnType
 
struct  has_std_result_type
 
struct  has_tr1_result
 
struct  has_unary_operator
 
struct  has_unary_operator< linspaced_op< Scalar, PacketType >, IndexType >
 
struct  has_unary_operator< scalar_constant_op< Scalar >, IndexType >
 
struct  has_unary_operator< scalar_identity_op< Scalar >, IndexType >
 
struct  has_unary_operator< scalar_random_op< Scalar >, IndexType >
 
struct  HessenbergDecompositionMatrixHReturnType
 Expression type for return value of HessenbergDecomposition::matrixH() More...
 
struct  homogeneous_left_product_impl
 
struct  homogeneous_left_product_impl< Homogeneous< MatrixType, Vertical >, Lhs >
 
struct  homogeneous_left_product_refactoring_helper
 
struct  homogeneous_right_product_impl
 
struct  homogeneous_right_product_impl< Homogeneous< MatrixType, Horizontal >, Rhs >
 
struct  homogeneous_right_product_refactoring_helper
 
struct  householder_qr_inplace_blocked
 
struct  HouseholderSequenceShape
 
struct  hseq_side_dependent_impl
 
struct  hseq_side_dependent_impl< VectorsType, CoeffsType, OnTheRight >
 
struct  image_retval
 
struct  image_retval< FullPivLU< _MatrixType > >
 
class  image_retval_base
 
struct  IndexBased
 
class  inner_iterator_selector
 
class  inner_iterator_selector< XprType, IndexBased >
 
class  inner_iterator_selector< XprType, IteratorBased >
 
struct  inner_stride_at_compile_time
 
struct  inner_stride_at_compile_time< Derived, false >
 
struct  inplace_transpose_selector
 
struct  inplace_transpose_selector< MatrixType, false, MatchPacketSize >
 
struct  inplace_transpose_selector< MatrixType, true, false >
 
struct  inplace_transpose_selector< MatrixType, true, true >
 
struct  inverse_impl
 
struct  is_arithmetic
 
struct  is_arithmetic< __m128 >
 
struct  is_arithmetic< __m128d >
 
struct  is_arithmetic< __m128i >
 
struct  is_arithmetic< __m256 >
 
struct  is_arithmetic< __m256d >
 
struct  is_arithmetic< __m256i >
 
struct  is_arithmetic< __m512 >
 
struct  is_arithmetic< __m512d >
 
struct  is_arithmetic< __m512i >
 
struct  is_arithmetic< bool >
 
struct  is_arithmetic< char >
 
struct  is_arithmetic< double >
 
struct  is_arithmetic< float >
 
struct  is_arithmetic< half >
 
struct  is_arithmetic< long double >
 
struct  is_arithmetic< signed char >
 
struct  is_arithmetic< signed int >
 
struct  is_arithmetic< signed long >
 
struct  is_arithmetic< signed short >
 
struct  is_arithmetic< unsigned char >
 
struct  is_arithmetic< unsigned int >
 
struct  is_arithmetic< unsigned long >
 
struct  is_arithmetic< unsigned short >
 
struct  is_const
 
struct  is_const< T const >
 
struct  is_convertible
 
struct  is_convertible_impl
 
struct  is_diagonal
 
struct  is_diagonal< DiagonalBase< T > >
 
struct  is_diagonal< DiagonalMatrix< T, S > >
 
struct  is_diagonal< DiagonalWrapper< T > >
 
struct  is_integral
 
struct  is_integral< bool >
 
struct  is_integral< char >
 
struct  is_integral< signed char >
 
struct  is_integral< signed int >
 
struct  is_integral< signed long >
 
struct  is_integral< signed short >
 
struct  is_integral< unsigned char >
 
struct  is_integral< unsigned int >
 
struct  is_integral< unsigned long >
 
struct  is_integral< unsigned short >
 
struct  is_lvalue
 
struct  is_ref_compatible
 
struct  is_ref_compatible_impl
 
struct  is_same
 
struct  is_same< T, T >
 
struct  isApprox_selector
 
struct  isApprox_selector< Derived, OtherDerived, true >
 
struct  isMuchSmallerThan_object_selector
 
struct  isMuchSmallerThan_object_selector< Derived, OtherDerived, true >
 
struct  isMuchSmallerThan_scalar_selector
 
struct  isMuchSmallerThan_scalar_selector< Derived, true >
 
struct  IteratorBased
 
struct  kernel_retval
 
struct  kernel_retval< FullPivLU< _MatrixType > >
 
class  kernel_retval_base
 
struct  lapacke_llt
 
struct  ldlt_inplace
 
struct  ldlt_inplace< Lower >
 
struct  ldlt_inplace< Upper >
 
struct  LDLT_Traits
 
struct  LDLT_Traits< MatrixType, Lower >
 
struct  LDLT_Traits< MatrixType, Upper >
 
class  level3_blocking
 
struct  linspaced_op
 
struct  linspaced_op_impl
 
struct  linspaced_op_impl< Scalar, Packet, false >
 
struct  linspaced_op_impl< Scalar, Packet, true >
 
struct  llt_inplace
 
struct  llt_inplace< Scalar, Lower >
 
struct  llt_inplace< Scalar, Upper >
 
struct  LLT_Traits
 
struct  LLT_Traits< MatrixType, Lower >
 
struct  LLT_Traits< MatrixType, Upper >
 
struct  lpNorm_selector
 
struct  lpNorm_selector< Derived, 1 >
 
struct  lpNorm_selector< Derived, 2 >
 
struct  lpNorm_selector< Derived, Infinity >
 
struct  LU_GlobalLU_t
 
struct  LU_kernel_bmod
 
struct  LU_kernel_bmod< 1 >
 
class  make_proper_matrix_type
 
struct  mapbase_evaluator
 
class  MappedSuperNodalMatrix
 a class to manipulate the L supernodal factor from the SparseLU factorization More...
 
struct  matrix_swap_impl
 
struct  matrix_swap_impl< MatrixTypeA, MatrixTypeB, true >
 
struct  matrix_type_times_scalar_type
 
struct  max_coeff_visitor
 
struct  member_lpnorm
 
struct  member_redux
 
struct  meta_least_common_multiple
 
struct  meta_least_common_multiple< A, B, K, true >
 
struct  meta_no
 
class  meta_sqrt
 
class  meta_sqrt< Y, InfX, SupX, true >
 
struct  meta_yes
 
struct  min_coeff_visitor
 
struct  mul_assign_op
 
struct  nested_eval
 
struct  nested_eval< ReturnByValue< Derived >, n, PlainObject >
 
class  no_assignment_operator
 
class  noncopyable
 
struct  nullary_wrapper
 
struct  nullary_wrapper< Scalar, NullaryOp, false, false, false >
 
struct  nullary_wrapper< Scalar, NullaryOp, false, false, true >
 
struct  nullary_wrapper< Scalar, NullaryOp, false, true, false >
 
struct  nullary_wrapper< Scalar, NullaryOp, true, false, false >
 
struct  outer_stride_at_compile_time
 
struct  outer_stride_at_compile_time< Derived, false >
 
union  Packet
 
struct  Packet1cd
 
struct  Packet2cd
 
struct  Packet2cf
 
struct  Packet4cf
 
struct  Packet4f
 
struct  packet_traits
 
struct  packet_traits< const T >
 
struct  packet_traits< double >
 
struct  packet_traits< float >
 
struct  packet_traits< int >
 
struct  packet_traits< std::complex< double > >
 
struct  packet_traits< std::complex< float > >
 
struct  PacketBlock
 
struct  palign_impl
 
struct  palign_impl< Offset, Packet16f >
 
struct  palign_impl< Offset, Packet1cd >
 
struct  palign_impl< Offset, Packet2cd >
 
struct  palign_impl< Offset, Packet2cf >
 
struct  palign_impl< Offset, Packet2d >
 
struct  palign_impl< Offset, Packet4cf >
 
struct  palign_impl< Offset, Packet4d >
 
struct  palign_impl< Offset, Packet4f >
 
struct  palign_impl< Offset, Packet4i >
 
struct  palign_impl< Offset, Packet8d >
 
struct  palign_impl< Offset, Packet8f >
 
struct  panel_dfs_traits
 
struct  pardiso_run_selector
 
struct  pardiso_run_selector< long long int >
 
struct  pardiso_traits
 
struct  pardiso_traits< PardisoLDLT< _MatrixType, Options > >
 
struct  pardiso_traits< PardisoLLT< _MatrixType, Options > >
 
struct  pardiso_traits< PardisoLU< _MatrixType > >
 
struct  partial_lu_impl
 
struct  pastix_traits
 
struct  pastix_traits< PastixLDLT< _MatrixType, Options > >
 
struct  pastix_traits< PastixLLT< _MatrixType, Options > >
 
struct  pastix_traits< PastixLU< _MatrixType > >
 
struct  perfvalues
 
struct  permutation_matrix_product
 
struct  permutation_matrix_product< ExpressionType, Side, Transposed, DenseShape >
 
struct  permutation_matrix_product< ExpressionType, Side, Transposed, HomogeneousShape >
 
struct  permutation_matrix_product< ExpressionType, Side, Transposed, SparseShape >
 
struct  plain_array
 
struct  plain_array< T, 0, MatrixOrArrayOptions, Alignment >
 
struct  plain_array< T, Size, MatrixOrArrayOptions, 16 >
 
struct  plain_array< T, Size, MatrixOrArrayOptions, 32 >
 
struct  plain_array< T, Size, MatrixOrArrayOptions, 64 >
 
struct  plain_array< T, Size, MatrixOrArrayOptions, 8 >
 
struct  plain_col_type
 
struct  plain_constant_type
 
struct  plain_diag_type
 
struct  plain_matrix_type
 
struct  plain_matrix_type< T, Dense >
 
struct  plain_matrix_type< T, DiagonalShape >
 
struct  plain_matrix_type< T, Sparse >
 
struct  plain_matrix_type_column_major
 
struct  plain_matrix_type_dense
 
struct  plain_matrix_type_dense< T, ArrayXpr, Flags >
 
struct  plain_matrix_type_dense< T, MatrixXpr, Flags >
 
struct  plain_matrix_type_row_major
 
struct  plain_object_eval
 
struct  plain_object_eval< T, Dense >
 
struct  plain_object_eval< T, Sparse >
 
struct  plain_row_type
 
struct  product_evaluator
 
struct  product_evaluator< Product< Lhs, Rhs, AliasFreeProduct >, ProductTag, PermutationShape, SparseShape >
 
struct  product_evaluator< Product< Lhs, Rhs, AliasFreeProduct >, ProductTag, SparseShape, PermutationShape >
 
struct  product_evaluator< Product< Lhs, Rhs, DefaultProduct >, LazyCoeffBasedProductMode, DenseShape, DenseShape >
 
struct  product_evaluator< Product< Lhs, Rhs, DefaultProduct >, OuterProduct, DenseShape, SparseShape >
 
struct  product_evaluator< Product< Lhs, Rhs, DefaultProduct >, OuterProduct, SparseShape, DenseShape >
 
struct  product_evaluator< Product< Lhs, Rhs, DefaultProduct >, ProductTag, DiagonalShape, SparseShape >
 
struct  product_evaluator< Product< Lhs, Rhs, DefaultProduct >, ProductTag, SparseShape, DiagonalShape >
 
struct  product_evaluator< Product< Lhs, Rhs, LazyProduct >, ProductTag, DenseShape, DenseShape >
 
struct  product_evaluator< Product< Lhs, Rhs, LazyProduct >, ProductTag, DenseShape, HomogeneousShape >
 
struct  product_evaluator< Product< Lhs, Rhs, LazyProduct >, ProductTag, HomogeneousShape, DenseShape >
 
struct  product_evaluator< Product< Lhs, Rhs, Options >, ProductTag, LhsShape, RhsShape >
 
struct  product_evaluator< Product< Lhs, Rhs, ProductKind >, ProductTag, DenseShape, DiagonalShape >
 
struct  product_evaluator< Product< Lhs, Rhs, ProductKind >, ProductTag, DiagonalShape, DenseShape >
 
struct  product_evaluator< Product< Lhs, RhsView, DefaultProduct >, ProductTag, SparseShape, SparseSelfAdjointShape >
 
struct  product_evaluator< Product< LhsView, Rhs, DefaultProduct >, ProductTag, SparseSelfAdjointShape, SparseShape >
 
struct  product_promote_storage_type
 
struct  product_promote_storage_type< A, A, ProductTag >
 
struct  product_promote_storage_type< A, Dense, ProductTag >
 
struct  product_promote_storage_type< A, DiagonalShape, ProductTag >
 
struct  product_promote_storage_type< A, PermutationStorage, ProductTag >
 
struct  product_promote_storage_type< Dense, B, ProductTag >
 
struct  product_promote_storage_type< Dense, Dense, ProductTag >
 
struct  product_promote_storage_type< Dense, DiagonalShape, ProductTag >
 
struct  product_promote_storage_type< Dense, PermutationStorage, ProductTag >
 
struct  product_promote_storage_type< Dense, Sparse, OuterProduct >
 
struct  product_promote_storage_type< DiagonalShape, B, ProductTag >
 
struct  product_promote_storage_type< DiagonalShape, Dense, ProductTag >
 
struct  product_promote_storage_type< PermutationStorage, B, ProductTag >
 
struct  product_promote_storage_type< PermutationStorage, Dense, ProductTag >
 
struct  product_promote_storage_type< PermutationStorage, Sparse, ProductTag >
 
struct  product_promote_storage_type< Sparse, Dense, OuterProduct >
 
struct  product_promote_storage_type< Sparse, PermutationStorage, ProductTag >
 
struct  product_selfadjoint_matrix
 
struct  product_selfadjoint_matrix< Scalar, Index, LhsStorageOrder, false, ConjugateLhs, RhsStorageOrder, true, ConjugateRhs, ColMajor >
 
struct  product_selfadjoint_matrix< Scalar, Index, LhsStorageOrder, LhsSelfAdjoint, ConjugateLhs, RhsStorageOrder, RhsSelfAdjoint, ConjugateRhs, RowMajor >
 
struct  product_selfadjoint_matrix< Scalar, Index, LhsStorageOrder, true, ConjugateLhs, RhsStorageOrder, false, ConjugateRhs, ColMajor >
 
struct  product_size_category
 
struct  product_triangular_matrix_matrix
 
struct  product_triangular_matrix_matrix< Scalar, Index, Mode, false, LhsStorageOrder, ConjugateLhs, RhsStorageOrder, ConjugateRhs, ColMajor, Version >
 
struct  product_triangular_matrix_matrix< Scalar, Index, Mode, LhsIsTriangular, LhsStorageOrder, ConjugateLhs, RhsStorageOrder, ConjugateRhs, RowMajor, Version >
 
struct  product_triangular_matrix_matrix< Scalar, Index, Mode, true, LhsStorageOrder, ConjugateLhs, RhsStorageOrder, ConjugateRhs, ColMajor, Version >
 
struct  product_triangular_matrix_matrix_trmm
 
struct  product_type
 
struct  product_type_selector
 
struct  product_type_selector< 1, 1, 1 >
 
struct  product_type_selector< 1, 1, Depth >
 
struct  product_type_selector< 1, Large, Large >
 
struct  product_type_selector< 1, Large, Small >
 
struct  product_type_selector< 1, N, 1 >
 
struct  product_type_selector< 1, Small, Large >
 
struct  product_type_selector< 1, Small, Small >
 
struct  product_type_selector< Large, 1, Large >
 
struct  product_type_selector< Large, 1, Small >
 
struct  product_type_selector< Large, Large, Large >
 
struct  product_type_selector< Large, Large, Small >
 
struct  product_type_selector< Large, Small, 1 >
 
struct  product_type_selector< Large, Small, Large >
 
struct  product_type_selector< Large, Small, Small >
 
struct  product_type_selector< M, 1, 1 >
 
struct  product_type_selector< M, N, 1 >
 
struct  product_type_selector< Small, 1, Large >
 
struct  product_type_selector< Small, 1, Small >
 
struct  product_type_selector< Small, Large, 1 >
 
struct  product_type_selector< Small, Large, Large >
 
struct  product_type_selector< Small, Large, Small >
 
struct  product_type_selector< Small, Small, 1 >
 
struct  product_type_selector< Small, Small, Large >
 
struct  product_type_selector< Small, Small, Small >
 
struct  projective_transform_inverse
 
struct  projective_transform_inverse< TransformType, Projective >
 
struct  promote_index_type
 
struct  promote_scalar_arg
 
struct  promote_scalar_arg< S, T, false >
 
struct  promote_scalar_arg< S, T, true >
 
struct  promote_scalar_arg_unsupported
 
struct  promote_scalar_arg_unsupported< ExprScalar, T, PromotedType, false, true >
 
struct  promote_scalar_arg_unsupported< S, T, PromotedType, ConvertibleToLiteral, false >
 
struct  promote_scalar_arg_unsupported< S, T, PromotedType, true, true >
 
struct  promote_scalar_arg_unsupported< S, T, S, false, true >
 
struct  promote_storage_type
 
struct  promote_storage_type< A, A >
 
struct  promote_storage_type< A, const A >
 
struct  promote_storage_type< const A, A >
 
struct  qr_preconditioner_impl
 
class  qr_preconditioner_impl< MatrixType, ColPivHouseholderQRPreconditioner, PreconditionIfMoreColsThanRows, true >
 
class  qr_preconditioner_impl< MatrixType, ColPivHouseholderQRPreconditioner, PreconditionIfMoreRowsThanCols, true >
 
class  qr_preconditioner_impl< MatrixType, FullPivHouseholderQRPreconditioner, PreconditionIfMoreColsThanRows, true >
 
class  qr_preconditioner_impl< MatrixType, FullPivHouseholderQRPreconditioner, PreconditionIfMoreRowsThanCols, true >
 
class  qr_preconditioner_impl< MatrixType, HouseholderQRPreconditioner, PreconditionIfMoreColsThanRows, true >
 
class  qr_preconditioner_impl< MatrixType, HouseholderQRPreconditioner, PreconditionIfMoreRowsThanCols, true >
 
class  qr_preconditioner_impl< MatrixType, QRPreconditioner, Case, false >
 
struct  qr_preconditioner_should_do_anything
 
struct  quat_conj
 
struct  quat_conj< Architecture::SSE, Derived, double, Alignment >
 
struct  quat_conj< Architecture::SSE, Derived, float, Alignment >
 
struct  quat_product
 
struct  quat_product< Architecture::SSE, Derived, OtherDerived, double, Alignment >
 
struct  quat_product< Architecture::SSE, Derived, OtherDerived, float, Aligned16 >
 
struct  quaternionbase_assign_impl
 
struct  quaternionbase_assign_impl< Other, 3, 3 >
 
struct  quaternionbase_assign_impl< Other, 4, 1 >
 
struct  random_default_impl< half, false, false >
 
struct  rcond_compute_sign
 
struct  rcond_compute_sign< Vector, Vector, false >
 
class  redux_evaluator
 
struct  redux_impl
 
struct  redux_impl< Func, Derived, DefaultTraversal, CompleteUnrolling >
 
struct  redux_impl< Func, Derived, DefaultTraversal, NoUnrolling >
 
struct  redux_impl< Func, Derived, LinearVectorizedTraversal, CompleteUnrolling >
 
struct  redux_impl< Func, Derived, LinearVectorizedTraversal, NoUnrolling >
 
struct  redux_impl< Func, Derived, SliceVectorizedTraversal, Unrolling >
 
struct  redux_novec_unroller
 
struct  redux_novec_unroller< Func, Derived, Start, 0 >
 
struct  redux_novec_unroller< Func, Derived, Start, 1 >
 
struct  redux_traits
 
struct  redux_vec_unroller
 
struct  redux_vec_unroller< Func, Derived, Start, 1 >
 
struct  ref_selector
 
struct  remove_all
 
struct  remove_all< const T >
 
struct  remove_all< T & >
 
struct  remove_all< T * >
 
struct  remove_all< T const & >
 
struct  remove_all< T const * >
 
struct  remove_const
 
struct  remove_const< const T >
 
struct  remove_const< const T[]>
 
struct  remove_const< const T[Size]>
 
struct  remove_pointer
 
struct  remove_pointer< T * >
 
struct  remove_pointer< T *const >
 
struct  remove_reference
 
struct  remove_reference< T & >
 
struct  result_of
 
struct  result_of< Func(ArgType)>
 
struct  result_of< Func(ArgType0, ArgType1)>
 
struct  result_of< Func(ArgType0, ArgType1, ArgType2)>
 
struct  result_of< scalar_cmp_op< LhsScalar, RhsScalar, Cmp >(LhsScalar, RhsScalar)>
 
struct  reverse_packet_cond
 
struct  reverse_packet_cond< PacketType, false >
 
struct  rotation_base_generic_product_selector
 
struct  rotation_base_generic_product_selector< RotationDerived, DiagonalMatrix< Scalar, Dim, MaxDim >, false >
 
struct  rotation_base_generic_product_selector< RotationDerived, MatrixType, false >
 
struct  rotation_base_generic_product_selector< RotationDerived, OtherVectorType, true >
 
struct  scalar_abs2_op
 
struct  scalar_abs_op
 
struct  scalar_acos_op
 
struct  scalar_arg_op
 
struct  scalar_asin_op
 
struct  scalar_atan_op
 
struct  scalar_betainc_op
 
struct  scalar_boolean_and_op
 
struct  scalar_boolean_not_op
 
struct  scalar_boolean_or_op
 
struct  scalar_boolean_xor_op
 
struct  scalar_cast_op
 
struct  scalar_cast_op< Eigen::half, float >
 
struct  scalar_cast_op< float, Eigen::half >
 
struct  scalar_cast_op< int, Eigen::half >
 
struct  scalar_ceil_op
 
struct  scalar_cmp_op
 
struct  scalar_cmp_op< LhsScalar, RhsScalar, cmp_EQ >
 
struct  scalar_cmp_op< LhsScalar, RhsScalar, cmp_GE >
 
struct  scalar_cmp_op< LhsScalar, RhsScalar, cmp_GT >
 
struct  scalar_cmp_op< LhsScalar, RhsScalar, cmp_LE >
 
struct  scalar_cmp_op< LhsScalar, RhsScalar, cmp_LT >
 
struct  scalar_cmp_op< LhsScalar, RhsScalar, cmp_NEQ >
 
struct  scalar_cmp_op< LhsScalar, RhsScalar, cmp_UNORD >
 
struct  scalar_conj_product_op
 
struct  scalar_conjugate_op
 
struct  scalar_constant_op
 
struct  scalar_cos_op
 
struct  scalar_cosh_op
 
struct  scalar_cube_op
 
struct  scalar_difference_op
 
struct  scalar_digamma_op
 
struct  scalar_div_cost
 
struct  scalar_div_cost< double, true >
 
struct  scalar_div_cost< float, true >
 
struct  scalar_div_cost< signed long, Vectorized, typename conditional< sizeof(long)==8, void, false_type >::type >
 
struct  scalar_div_cost< std::complex< T >, Vectorized >
 
struct  scalar_div_cost< unsigned long, Vectorized, typename conditional< sizeof(long)==8, void, false_type >::type >
 
struct  scalar_erf_op
 
struct  scalar_erfc_op
 
struct  scalar_exp_op
 
struct  scalar_floor_op
 
struct  scalar_hypot_op
 
struct  scalar_hypot_op< Scalar, Scalar >
 
struct  scalar_identity_op
 
struct  scalar_igamma_op
 
struct  scalar_igammac_op
 
struct  scalar_imag_op
 
struct  scalar_imag_ref_op
 
struct  scalar_inverse_op
 
struct  scalar_isfinite_op
 
struct  scalar_isinf_op
 
struct  scalar_isnan_op
 
struct  scalar_lgamma_op
 
struct  scalar_log10_op
 
struct  scalar_log1p_op
 
struct  scalar_log_op
 
struct  scalar_max_op
 
struct  scalar_min_op
 
struct  scalar_opposite_op
 
struct  scalar_pow_op
 
struct  scalar_product_op
 
struct  scalar_product_traits
 
struct  scalar_quotient_op
 
struct  scalar_random_op
 
struct  scalar_real_op
 
struct  scalar_real_ref_op
 
struct  scalar_round_op
 
struct  scalar_rsqrt_op
 
struct  scalar_score_coeff_op
 
struct  scalar_sign_op
 
struct  scalar_sign_op< Scalar, false >
 
struct  scalar_sign_op< Scalar, true >
 
struct  scalar_sin_op
 
struct  scalar_sinh_op
 
struct  scalar_sqrt_op
 
struct  scalar_square_op
 
struct  scalar_sum_op
 
struct  scalar_sum_op< bool, bool >
 
struct  scalar_tan_op
 
struct  scalar_tanh_op
 
struct  scalar_zeta_op
 
class  scoped_array
 
struct  Selector
 
struct  selfadjoint_matrix_vector_product
 
struct  selfadjoint_matrix_vector_product_symv
 
struct  selfadjoint_product_impl
 
struct  selfadjoint_product_impl< Lhs, 0, true, Rhs, RhsMode, false >
 
struct  selfadjoint_product_impl< Lhs, LhsMode, false, Rhs, 0, true >
 
struct  selfadjoint_product_impl< Lhs, LhsMode, false, Rhs, RhsMode, false >
 
struct  selfadjoint_rank2_update_selector
 
struct  selfadjoint_rank2_update_selector< Scalar, Index, UType, VType, Lower >
 
struct  selfadjoint_rank2_update_selector< Scalar, Index, UType, VType, Upper >
 
struct  setIdentity_impl
 
struct  setIdentity_impl< Derived, true >
 
struct  significant_decimals_impl
 
struct  simplicial_cholesky_grab_input
 
struct  simplicial_cholesky_grab_input< MatrixType, MatrixType >
 
struct  size_at_compile_time
 
struct  size_of_xpr_at_compile_time
 
struct  smart_copy_helper
 
struct  smart_copy_helper< T, false >
 
struct  smart_copy_helper< T, true >
 
struct  smart_memmove_helper
 
struct  smart_memmove_helper< T, false >
 
struct  smart_memmove_helper< T, true >
 
struct  solve_traits
 
struct  solve_traits< Decomposition, RhsType, Dense >
 
struct  solve_traits< Decomposition, RhsType, Sparse >
 
struct  Sparse2Dense
 
struct  Sparse2Sparse
 
struct  sparse_conjunction_evaluator
 
struct  sparse_conjunction_evaluator< XprType, IndexBased, IteratorBased >
 
struct  sparse_conjunction_evaluator< XprType, IteratorBased, IndexBased >
 
struct  sparse_conjunction_evaluator< XprType, IteratorBased, IteratorBased >
 
struct  sparse_dense_outer_product_evaluator
 
struct  sparse_diagonal_product_evaluator
 
struct  sparse_diagonal_product_evaluator< SparseXprType, DiagCoeffType, SDP_AsCwiseProduct >
 
struct  sparse_diagonal_product_evaluator< SparseXprType, DiagonalCoeffType, SDP_AsScalarProduct >
 
struct  sparse_eval
 
struct  sparse_eval< T, 1, 1, Flags >
 
struct  sparse_eval< T, 1, Cols, Flags >
 
struct  sparse_eval< T, Rows, 1, Flags >
 
class  sparse_matrix_block_impl
 
struct  sparse_solve_triangular_selector
 
struct  sparse_solve_triangular_selector< Lhs, Rhs, Mode, Lower, ColMajor >
 
struct  sparse_solve_triangular_selector< Lhs, Rhs, Mode, Lower, RowMajor >
 
struct  sparse_solve_triangular_selector< Lhs, Rhs, Mode, Upper, ColMajor >
 
struct  sparse_solve_triangular_selector< Lhs, Rhs, Mode, Upper, RowMajor >
 
struct  sparse_solve_triangular_sparse_selector
 
struct  sparse_solve_triangular_sparse_selector< Lhs, Rhs, Mode, UpLo, ColMajor >
 
struct  sparse_sparse_product_with_pruning_selector
 
struct  sparse_sparse_product_with_pruning_selector< Lhs, Rhs, ResultType, ColMajor, ColMajor, ColMajor >
 
struct  sparse_sparse_product_with_pruning_selector< Lhs, Rhs, ResultType, ColMajor, ColMajor, RowMajor >
 
struct  sparse_sparse_product_with_pruning_selector< Lhs, Rhs, ResultType, ColMajor, RowMajor, ColMajor >
 
struct  sparse_sparse_product_with_pruning_selector< Lhs, Rhs, ResultType, ColMajor, RowMajor, RowMajor >
 
struct  sparse_sparse_product_with_pruning_selector< Lhs, Rhs, ResultType, RowMajor, ColMajor, ColMajor >
 
struct  sparse_sparse_product_with_pruning_selector< Lhs, Rhs, ResultType, RowMajor, ColMajor, RowMajor >
 
struct  sparse_sparse_product_with_pruning_selector< Lhs, Rhs, ResultType, RowMajor, RowMajor, ColMajor >
 
struct  sparse_sparse_product_with_pruning_selector< Lhs, Rhs, ResultType, RowMajor, RowMajor, RowMajor >
 
struct  sparse_sparse_to_dense_product_selector
 
struct  sparse_sparse_to_dense_product_selector< Lhs, Rhs, ResultType, ColMajor, ColMajor >
 
struct  sparse_sparse_to_dense_product_selector< Lhs, Rhs, ResultType, ColMajor, RowMajor >
 
struct  sparse_sparse_to_dense_product_selector< Lhs, Rhs, ResultType, RowMajor, ColMajor >
 
struct  sparse_sparse_to_dense_product_selector< Lhs, Rhs, ResultType, RowMajor, RowMajor >
 
struct  sparse_time_dense_product_impl
 
struct  sparse_time_dense_product_impl< SparseLhsType, DenseRhsType, DenseResType, AlphaType, ColMajor, true >
 
struct  sparse_time_dense_product_impl< SparseLhsType, DenseRhsType, DenseResType, typename DenseResType::Scalar, ColMajor, false >
 
struct  sparse_time_dense_product_impl< SparseLhsType, DenseRhsType, DenseResType, typename DenseResType::Scalar, RowMajor, false >
 
struct  sparse_time_dense_product_impl< SparseLhsType, DenseRhsType, DenseResType, typename DenseResType::Scalar, RowMajor, true >
 
struct  sparse_vector_assign_selector
 
struct  sparse_vector_assign_selector< Dest, Src, SVA_Inner >
 
struct  sparse_vector_assign_selector< Dest, Src, SVA_Outer >
 
struct  sparse_vector_assign_selector< Dest, Src, SVA_RuntimeSwitch >
 
class  SparseLUImpl
 
class  SparseRefBase
 
struct  SparseSelfAdjoint2Sparse
 
struct  SparseSelfAdjointShape
 
class  SparseTransposeImpl
 
class  SparseTransposeImpl< MatrixType, CompressedAccessBit >
 
struct  SparseTriangularShape
 
struct  static_assertion
 
struct  static_assertion< true >
 
struct  stem_function
 
struct  storage_kind_to_evaluator_kind
 
struct  storage_kind_to_evaluator_kind< Sparse >
 
struct  storage_kind_to_shape
 
struct  storage_kind_to_shape< Dense >
 
struct  storage_kind_to_shape< DiagonalShape >
 
struct  storage_kind_to_shape< PermutationStorage >
 
struct  storage_kind_to_shape< SolverStorage >
 
struct  storage_kind_to_shape< Sparse >
 
struct  storage_kind_to_shape< TranspositionsStorage >
 
struct  sub_assign_op
 
struct  svd_precondition_2x2_block_to_be_real
 
struct  svd_precondition_2x2_block_to_be_real< MatrixType, QRPreconditioner, false >
 
struct  svd_precondition_2x2_block_to_be_real< MatrixType, QRPreconditioner, true >
 
struct  swap_assign_op
 
struct  symm_pack_lhs
 
struct  symm_pack_rhs
 
struct  take_matrix_for_product
 
struct  take_matrix_for_product< Transform< Scalar, Dim, Mode, Options > >
 
struct  take_matrix_for_product< Transform< Scalar, Dim, Projective, Options > >
 
struct  ternary_evaluator
 
struct  ternary_evaluator< CwiseTernaryOp< TernaryOp, Arg1, Arg2, Arg3 >, IndexBased, IndexBased >
 
struct  ternary_result_of_select
 
struct  ternary_result_of_select< Func, ArgType0, ArgType1, ArgType2, sizeof(has_std_result_type)>
 
struct  ternary_result_of_select< Func, ArgType0, ArgType1, ArgType2, sizeof(has_tr1_result)>
 
struct  traits
 
struct  traits< AngleAxis< _Scalar > >
 
struct  traits< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >
 
struct  traits< ArrayWrapper< ExpressionType > >
 
struct  traits< BandMatrix< _Scalar, _Rows, _Cols, _Supers, _Subs, _Options > >
 
struct  traits< BandMatrixWrapper< _CoefficientsType, _Rows, _Cols, _Supers, _Subs, _Options > >
 
struct  traits< BDCSVD< _MatrixType > >
 
struct  traits< BiCGSTAB< _MatrixType, _Preconditioner > >
 
struct  traits< Block< XprType, BlockRows, BlockCols, InnerPanel > >
 
struct  traits< ColPivHouseholderQR< _MatrixType > >
 
struct  traits< CompleteOrthogonalDecomposition< _MatrixType > >
 
struct  traits< ConjugateGradient< _MatrixType, _UpLo, _Preconditioner > >
 
struct  traits< const T >
 
struct  traits< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >
 
struct  traits< CwiseNullaryOp< NullaryOp, PlainObjectType > >
 
struct  traits< CwiseTernaryOp< TernaryOp, Arg1, Arg2, Arg3 > >
 
struct  traits< CwiseUnaryOp< UnaryOp, XprType > >
 
struct  traits< CwiseUnaryView< ViewOp, MatrixType > >
 
struct  traits< Diagonal< const SparseMatrix< _Scalar, _Options, _Index >, DiagIndex > >
 
struct  traits< Diagonal< MatrixType, DiagIndex > >
 
struct  traits< Diagonal< SparseMatrix< _Scalar, _Options, _Index >, DiagIndex > >
 
struct  traits< DiagonalMatrix< _Scalar, SizeAtCompileTime, MaxSizeAtCompileTime > >
 
struct  traits< DiagonalWrapper< _DiagonalVectorType > >
 
struct  traits< EvalToTemp< ArgType > >
 
struct  traits< ForceAlignedAccess< ExpressionType > >
 
struct  traits< FullPivHouseholderQR< _MatrixType > >
 
struct  traits< FullPivHouseholderQRMatrixQReturnType< MatrixType > >
 
struct  traits< FullPivLU< _MatrixType > >
 
struct  traits< HessenbergDecompositionMatrixHReturnType< MatrixType > >
 
struct  traits< Homogeneous< MatrixType, Direction > >
 
struct  traits< homogeneous_left_product_impl< Homogeneous< MatrixType, Vertical >, Lhs > >
 
struct  traits< homogeneous_right_product_impl< Homogeneous< MatrixType, Horizontal >, Rhs > >
 
struct  traits< HouseholderSequence< VectorsType, CoeffsType, Side > >
 
struct  traits< image_retval_base< DecompositionType > >
 
struct  traits< Inverse< XprType > >
 
struct  traits< JacobiSVD< _MatrixType, QRPreconditioner > >
 
struct  traits< kernel_retval_base< DecompositionType > >
 
struct  traits< LeastSquaresConjugateGradient< _MatrixType, _Preconditioner > >
 
struct  traits< Map< const Quaternion< _Scalar >, _Options > >
 
struct  traits< Map< const SparseMatrix< MatScalar, MatOptions, MatIndex >, Options, StrideType > >
 
struct  traits< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >
 
struct  traits< Map< PlainObjectType, MapOptions, StrideType > >
 
struct  traits< Map< Quaternion< _Scalar >, _Options > >
 
struct  traits< Map< SparseMatrix< MatScalar, MatOptions, MatIndex >, Options, StrideType > >
 
struct  traits< Map< Transpositions< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >
 
struct  traits< MappedSparseMatrix< _Scalar, _Flags, _StorageIndex > >
 
struct  traits< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >
 
struct  traits< MatrixWrapper< ExpressionType > >
 
struct  traits< NestByValue< ExpressionType > >
 
struct  traits< PartialPivLU< _MatrixType > >
 
struct  traits< PartialReduxExpr< MatrixType, MemberOp, Direction > >
 
struct  traits< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >
 
struct  traits< PermutationWrapper< _IndicesType > >
 
struct  traits< Product< Lhs, Rhs, Option > >
 
struct  traits< Quaternion< _Scalar, _Options > >
 
struct  traits< Ref< _PlainObjectType, _Options, _StrideType > >
 
struct  traits< Ref< const SparseMatrix< MatScalar, MatOptions, MatIndex >, _Options, _StrideType > >
 
struct  traits< Ref< const SparseVector< MatScalar, MatOptions, MatIndex >, _Options, _StrideType > >
 
struct  traits< Ref< SparseMatrix< MatScalar, MatOptions, MatIndex >, _Options, _StrideType > >
 
struct  traits< Ref< SparseVector< MatScalar, MatOptions, MatIndex >, _Options, _StrideType > >
 
struct  traits< RefBase< Derived > >
 
struct  traits< Replicate< MatrixType, RowFactor, ColFactor > >
 
struct  traits< ReturnByValue< Derived > >
 
struct  traits< Reverse< MatrixType, Direction > >
 
struct  traits< Rotation2D< _Scalar > >
 
struct  traits< Select< ConditionMatrixType, ThenMatrixType, ElseMatrixType > >
 
struct  traits< SelfAdjointView< MatrixType, UpLo > >
 
struct  traits< SimplicialCholesky< _MatrixType, _UpLo, _Ordering > >
 
struct  traits< SimplicialLDLT< _MatrixType, _UpLo, _Ordering > >
 
struct  traits< SimplicialLLT< _MatrixType, _UpLo, _Ordering > >
 
struct  traits< Solve< Decomposition, RhsType > >
 
struct  traits< SolveWithGuess< Decomposition, RhsType, GuessType > >
 
struct  traits< SparseCompressedBase< Derived > >
 
struct  traits< SparseMatrix< _Scalar, _Options, _Index > >
 
struct  traits< SparseQR_QProduct< SparseQRType, Derived > >
 
struct  traits< SparseQRMatrixQReturnType< SparseQRType > >
 
struct  traits< SparseQRMatrixQTransposeReturnType< SparseQRType > >
 
struct  traits< SparseRefBase< Derived > >
 
struct  traits< SparseSelfAdjointView< MatrixType, Mode > >
 
struct  traits< SparseSymmetricPermutationProduct< MatrixType, Mode > >
 
struct  traits< SparseVector< _Scalar, _Options, _StorageIndex > >
 
struct  traits< SparseView< MatrixType > >
 
struct  traits< SPQR_QProduct< SPQRType, Derived > >
 
struct  traits< SPQRMatrixQReturnType< SPQRType > >
 
struct  traits< SPQRMatrixQTransposeReturnType< SPQRType > >
 
struct  traits< Transform< _Scalar, _Dim, _Mode, _Options > >
 
struct  traits< Transpose< MatrixType > >
 
struct  traits< Transpose< TranspositionsBase< Derived > > >
 
struct  traits< Transpositions< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >
 
struct  traits< TranspositionsWrapper< _IndicesType > >
 
struct  traits< triangular_solve_retval< Side, TriangularType, Rhs > >
 
struct  traits< TriangularView< MatrixType, _Mode > >
 
struct  traits< TridiagonalizationMatrixTReturnType< MatrixType > >
 
struct  traits< VectorBlock< VectorType, Size > >
 
struct  transfer_constness
 
struct  transform_construct_from_matrix
 
struct  transform_construct_from_matrix< Other, AffineCompact, Options, Dim, HDim, HDim, HDim >
 
struct  transform_construct_from_matrix< Other, Mode, Options, Dim, HDim, Dim, Dim >
 
struct  transform_construct_from_matrix< Other, Mode, Options, Dim, HDim, Dim, HDim >
 
struct  transform_construct_from_matrix< Other, Mode, Options, Dim, HDim, HDim, HDim >
 
struct  transform_left_product_impl
 
struct  transform_left_product_impl< Other, AffineCompact, Options, Dim, HDim, Dim, HDim >
 
struct  transform_left_product_impl< Other, AffineCompact, Options, Dim, HDim, HDim, HDim >
 
struct  transform_left_product_impl< Other, Mode, Options, Dim, HDim, Dim, Dim >
 
struct  transform_left_product_impl< Other, Mode, Options, Dim, HDim, Dim, HDim >
 
struct  transform_left_product_impl< Other, Mode, Options, Dim, HDim, HDim, HDim >
 
struct  transform_make_affine
 
struct  transform_make_affine< AffineCompact >
 
struct  transform_product_result
 
struct  transform_right_product_impl
 
struct  transform_right_product_impl< TransformType, MatrixType, 0, RhsCols >
 
struct  transform_right_product_impl< TransformType, MatrixType, 1, RhsCols >
 
struct  transform_right_product_impl< TransformType, MatrixType, 2, 1 >
 
struct  transform_right_product_impl< TransformType, MatrixType, 2, RhsCols >
 
struct  transform_take_affine_part
 
struct  transform_take_affine_part< Transform< Scalar, Dim, AffineCompact, Options > >
 
struct  transform_traits
 
struct  transform_transform_product_impl
 
struct  transform_transform_product_impl< Transform< Scalar, Dim, AffineCompact, LhsOptions >, Transform< Scalar, Dim, Projective, RhsOptions >, true >
 
struct  transform_transform_product_impl< Transform< Scalar, Dim, LhsMode, LhsOptions >, Transform< Scalar, Dim, RhsMode, RhsOptions >, false >
 
struct  transform_transform_product_impl< Transform< Scalar, Dim, LhsMode, LhsOptions >, Transform< Scalar, Dim, RhsMode, RhsOptions >, true >
 
struct  transform_transform_product_impl< Transform< Scalar, Dim, Projective, LhsOptions >, Transform< Scalar, Dim, AffineCompact, RhsOptions >, true >
 
struct  TransposeImpl_base
 
struct  TransposeImpl_base< MatrixType, false >
 
struct  transposition_matrix_product
 
struct  Triangular2Dense
 
struct  Triangular2Triangular
 
struct  triangular_assignment_loop
 
struct  triangular_assignment_loop< Kernel, Mode, 0, SetOpposite >
 
struct  triangular_assignment_loop< Kernel, Mode, Dynamic, SetOpposite >
 
class  triangular_dense_assignment_kernel
 
class  triangular_dense_assignment_kernel< UpLo, SelfAdjoint, SetOpposite, DstEvaluatorTypeT, SrcEvaluatorTypeT, Functor, Version >
 
struct  triangular_matrix_vector_product
 
struct  triangular_matrix_vector_product< Index, Mode, LhsScalar, ConjLhs, RhsScalar, ConjRhs, ColMajor, Version >
 
struct  triangular_matrix_vector_product< Index, Mode, LhsScalar, ConjLhs, RhsScalar, ConjRhs, RowMajor, Version >
 
struct  triangular_matrix_vector_product_trmv
 
struct  triangular_product_impl
 
struct  triangular_product_impl< Mode, false, Lhs, true, Rhs, false >
 
struct  triangular_product_impl< Mode, LhsIsTriangular, Lhs, false, Rhs, false >
 
struct  triangular_product_impl< Mode, true, Lhs, false, Rhs, true >
 
struct  triangular_solve_matrix
 
struct  triangular_solve_matrix< Scalar, Index, OnTheLeft, Mode, Conjugate, TriStorageOrder, ColMajor >
 
struct  triangular_solve_matrix< Scalar, Index, OnTheRight, Mode, Conjugate, TriStorageOrder, ColMajor >
 
struct  triangular_solve_matrix< Scalar, Index, Side, Mode, Conjugate, TriStorageOrder, RowMajor >
 
struct  triangular_solve_retval
 
struct  triangular_solve_vector
 
struct  triangular_solve_vector< LhsScalar, RhsScalar, Index, OnTheLeft, Mode, Conjugate, ColMajor >
 
struct  triangular_solve_vector< LhsScalar, RhsScalar, Index, OnTheLeft, Mode, Conjugate, RowMajor >
 
struct  triangular_solve_vector< LhsScalar, RhsScalar, Index, OnTheRight, Mode, Conjugate, StorageOrder >
 
struct  triangular_solver_selector
 
struct  triangular_solver_selector< Lhs, Rhs, OnTheLeft, Mode, CompleteUnrolling, 1 >
 
struct  triangular_solver_selector< Lhs, Rhs, OnTheRight, Mode, CompleteUnrolling, 1 >
 
struct  triangular_solver_selector< Lhs, Rhs, Side, Mode, NoUnrolling, 1 >
 
struct  triangular_solver_selector< Lhs, Rhs, Side, Mode, NoUnrolling, Dynamic >
 
struct  triangular_solver_unroller
 
struct  triangular_solver_unroller< Lhs, Rhs, Mode, LoopIndex, Size, false >
 
struct  triangular_solver_unroller< Lhs, Rhs, Mode, LoopIndex, Size, true >
 
struct  tribb_kernel
 
struct  tridiagonalization_inplace_selector
 
struct  tridiagonalization_inplace_selector< MatrixType, 1, IsComplex >
 
struct  tridiagonalization_inplace_selector< MatrixType, 3, false >
 
struct  TridiagonalizationMatrixTReturnType
 
class  TridiagonalMatrix
 Represents a tridiagonal matrix with a compact banded storage. More...
 
struct  trmv_selector
 
struct  trmv_selector< Mode, ColMajor >
 
struct  trmv_selector< Mode, RowMajor >
 
class  trsolve_traits
 
struct  true_type
 
struct  type_casting_traits
 
struct  type_casting_traits< double, float >
 
struct  type_casting_traits< float, double >
 
struct  type_casting_traits< float, int >
 
struct  type_casting_traits< int, float >
 
struct  umeyama_transform_matrix_type
 
struct  unaligned_dense_assignment_loop
 
struct  unaligned_dense_assignment_loop< false >
 
struct  unary_evaluator
 
struct  unary_evaluator< ArrayWrapper< TArgType > >
 
struct  unary_evaluator< Block< ArgType, BlockRows, BlockCols, InnerPanel >, IndexBased >
 
struct  unary_evaluator< Block< ArgType, BlockRows, BlockCols, InnerPanel >, IteratorBased >
 
struct  unary_evaluator< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true >, IteratorBased >
 
struct  unary_evaluator< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true >, IteratorBased >
 
struct  unary_evaluator< CwiseUnaryOp< UnaryOp, ArgType >, IndexBased >
 
struct  unary_evaluator< CwiseUnaryOp< UnaryOp, ArgType >, IteratorBased >
 
struct  unary_evaluator< CwiseUnaryView< UnaryOp, ArgType >, IndexBased >
 
struct  unary_evaluator< CwiseUnaryView< ViewOp, ArgType >, IteratorBased >
 
struct  unary_evaluator< Homogeneous< ArgType, Direction >, IndexBased >
 
struct  unary_evaluator< Inverse< ArgType > >
 
struct  unary_evaluator< MatrixWrapper< TArgType > >
 
struct  unary_evaluator< Replicate< ArgType, RowFactor, ColFactor > >
 
struct  unary_evaluator< Reverse< ArgType, Direction > >
 
struct  unary_evaluator< SparseView< ArgType >, IndexBased >
 
struct  unary_evaluator< SparseView< ArgType >, IteratorBased >
 
struct  unary_evaluator< SparseView< Product< Lhs, Rhs, Options > >, IteratorBased >
 
struct  unary_evaluator< Transpose< ArgType >, IndexBased >
 
struct  unary_evaluator< Transpose< ArgType >, IteratorBased >
 
struct  unary_evaluator< TriangularView< ArgType, Mode >, IteratorBased >
 
struct  unary_evaluator< TriangularView< MatrixType, Mode >, IndexBased >
 
struct  unary_result_of_select
 
struct  unary_result_of_select< Func, ArgType, sizeof(has_std_result_type)>
 
struct  unary_result_of_select< Func, ArgType, sizeof(has_tr1_result)>
 
struct  unitOrthogonal_selector
 
struct  unitOrthogonal_selector< Derived, 2 >
 
struct  unitOrthogonal_selector< Derived, 3 >
 
struct  unpacket_traits
 
struct  unpacket_traits< DoublePacket< Packet > >
 
struct  unpacket_traits< Packet16f >
 
struct  unpacket_traits< Packet16i >
 
struct  unpacket_traits< Packet1cd >
 
struct  unpacket_traits< Packet2cd >
 
struct  unpacket_traits< Packet2cf >
 
struct  unpacket_traits< Packet2d >
 
struct  unpacket_traits< Packet4cf >
 
struct  unpacket_traits< Packet4d >
 
struct  unpacket_traits< Packet4f >
 
struct  unpacket_traits< Packet4i >
 
struct  unpacket_traits< Packet8d >
 
struct  unpacket_traits< Packet8f >
 
struct  unpacket_traits< Packet8i >
 
class  UpperBidiagonalization
 
class  variable_if_dynamic
 
class  variable_if_dynamic< T, Dynamic >
 
class  variable_if_dynamicindex
 
class  variable_if_dynamicindex< T, DynamicIndex >
 
struct  vectorwise_reverse_inplace_impl
 
struct  vectorwise_reverse_inplace_impl< Horizontal >
 
struct  vectorwise_reverse_inplace_impl< Vertical >
 
class  visitor_evaluator
 
struct  visitor_impl
 
struct  visitor_impl< Visitor, Derived, 1 >
 
struct  visitor_impl< Visitor, Derived, Dynamic >
 
class  vml_assign_traits
 

Typedefs

typedef std::ptrdiff_t IntPtr
 
typedef __m512 Packet16f
 
typedef __m512i Packet16i
 
typedef __vector unsigned char Packet16uc
 
typedef __m128d Packet2d
 
typedef float32x2_t Packet2f
 
typedef int32x2_t Packet2i
 
typedef __vector long long Packet2l
 
typedef __vector unsigned long long Packet2ul
 
typedef __vector __bool int Packet4bi
 
typedef __m256d Packet4d
 
typedef __vector float Packet4f
 
typedef __vector int Packet4i
 
typedef __vector unsigned int Packet4ui
 
typedef __m512d Packet8d
 
typedef __m256 Packet8f
 
typedef __vector short int Packet8i
 
typedef std::size_t UIntPtr
 

Enumerations

enum  { SDP_AsScalarProduct, SDP_AsCwiseProduct }
 
enum  { SVA_RuntimeSwitch, SVA_Inner, SVA_Outer }
 
enum  { LUNoMarker = 3 }
 
enum  { emptyIdxLU = -1 }
 
enum  { PreconditionIfMoreColsThanRows, PreconditionIfMoreRowsThanCols }
 
enum  ComparisonName {
  cmp_EQ = 0, cmp_LT = 1, cmp_LE = 2, cmp_UNORD = 3,
  cmp_NEQ = 4, cmp_GT = 5, cmp_GE = 6
}
 
enum  MemType {
  LUSUP, UCOL, LSUB, USUB,
  LLVL, ULVL
}
 
enum  PermPermProduct_t { PermPermProduct }
 
enum  SignMatrix { PositiveSemiDef, NegativeSemiDef, ZeroSign, Indefinite }
 

Functions

static _EIGEN_DECLARE_CONST_FAST_Packet2d (ZERO, 0)
 
static _EIGEN_DECLARE_CONST_FAST_Packet2l (ZERO, 0)
 
static _EIGEN_DECLARE_CONST_FAST_Packet2l (ONE, 1)
 
static _EIGEN_DECLARE_CONST_FAST_Packet4f (ZERO, 0)
 
static _EIGEN_DECLARE_CONST_FAST_Packet4i (ZERO, 0)
 
static _EIGEN_DECLARE_CONST_FAST_Packet4i (ONE, 1)
 
static _EIGEN_DECLARE_CONST_FAST_Packet4i (MINUS16,-16)
 
static _EIGEN_DECLARE_CONST_FAST_Packet4i (MINUS1,-1)
 
static _EIGEN_DECLARE_CONST_FAST_Packet4i (ONE, 1)
 
static _EIGEN_DECLARE_CONST_Packet2d (1, 1.0)
 
static _EIGEN_DECLARE_CONST_Packet2d (2, 2.0)
 
static _EIGEN_DECLARE_CONST_Packet2d (half, 0.5)
 
static _EIGEN_DECLARE_CONST_Packet2d (exp_hi, 709.437)
 
static _EIGEN_DECLARE_CONST_Packet2d (exp_lo, -709.436139303)
 
static _EIGEN_DECLARE_CONST_Packet2d (cephes_LOG2EF, 1.4426950408889634073599)
 
static _EIGEN_DECLARE_CONST_Packet2d (cephes_exp_p0, 1.26177193074810590878e-4)
 
static _EIGEN_DECLARE_CONST_Packet2d (cephes_exp_p1, 3.02994407707441961300e-2)
 
static _EIGEN_DECLARE_CONST_Packet2d (cephes_exp_p2, 9.99999999999999999910e-1)
 
static _EIGEN_DECLARE_CONST_Packet2d (cephes_exp_q0, 3.00198505138664455042e-6)
 
static _EIGEN_DECLARE_CONST_Packet2d (cephes_exp_q1, 2.52448340349684104192e-3)
 
static _EIGEN_DECLARE_CONST_Packet2d (cephes_exp_q2, 2.27265548208155028766e-1)
 
static _EIGEN_DECLARE_CONST_Packet2d (cephes_exp_q3, 2.00000000000000000009e0)
 
static _EIGEN_DECLARE_CONST_Packet2d (cephes_exp_C1, 0.693145751953125)
 
static _EIGEN_DECLARE_CONST_Packet2d (cephes_exp_C2, 1.42860682030941723212e-6)
 
static _EIGEN_DECLARE_CONST_Packet4f (1, 1.0f)
 
static _EIGEN_DECLARE_CONST_Packet4f (half, 0.5f)
 
static _EIGEN_DECLARE_CONST_Packet4f (cephes_SQRTHF, 0.707106781186547524f)
 
static _EIGEN_DECLARE_CONST_Packet4f (cephes_log_p0, 7.0376836292E-2f)
 
static _EIGEN_DECLARE_CONST_Packet4f (cephes_log_p1, - 1.1514610310E-1f)
 
static _EIGEN_DECLARE_CONST_Packet4f (cephes_log_p2, 1.1676998740E-1f)
 
static _EIGEN_DECLARE_CONST_Packet4f (cephes_log_p3, - 1.2420140846E-1f)
 
static _EIGEN_DECLARE_CONST_Packet4f (cephes_log_p4,+1.4249322787E-1f)
 
static _EIGEN_DECLARE_CONST_Packet4f (cephes_log_p5, - 1.6668057665E-1f)
 
static _EIGEN_DECLARE_CONST_Packet4f (cephes_log_p6,+2.0000714765E-1f)
 
static _EIGEN_DECLARE_CONST_Packet4f (cephes_log_p7, - 2.4999993993E-1f)
 
static _EIGEN_DECLARE_CONST_Packet4f (cephes_log_p8,+3.3333331174E-1f)
 
static _EIGEN_DECLARE_CONST_Packet4f (cephes_log_q1, -2.12194440e-4f)
 
static _EIGEN_DECLARE_CONST_Packet4f (cephes_log_q2, 0.693359375f)
 
static _EIGEN_DECLARE_CONST_Packet4f (exp_hi, 88.3762626647950f)
 
static _EIGEN_DECLARE_CONST_Packet4f (exp_lo, -88.3762626647949f)
 
static _EIGEN_DECLARE_CONST_Packet4f (cephes_LOG2EF, 1.44269504088896341f)
 
static _EIGEN_DECLARE_CONST_Packet4f (cephes_exp_C1, 0.693359375f)
 
static _EIGEN_DECLARE_CONST_Packet4f (cephes_exp_C2, -2.12194440e-4f)
 
static _EIGEN_DECLARE_CONST_Packet4f (cephes_exp_p0, 1.9875691500E-4f)
 
static _EIGEN_DECLARE_CONST_Packet4f (cephes_exp_p1, 1.3981999507E-3f)
 
static _EIGEN_DECLARE_CONST_Packet4f (cephes_exp_p2, 8.3334519073E-3f)
 
static _EIGEN_DECLARE_CONST_Packet4f (cephes_exp_p3, 4.1665795894E-2f)
 
static _EIGEN_DECLARE_CONST_Packet4f (cephes_exp_p4, 1.6666665459E-1f)
 
static _EIGEN_DECLARE_CONST_Packet4f (cephes_exp_p5, 5.0000001201E-1f)
 
static _EIGEN_DECLARE_CONST_Packet4f_FROM_INT (inv_mant_mask, ~0x7f800000)
 
static _EIGEN_DECLARE_CONST_Packet4f_FROM_INT (min_norm_pos, 0x00800000)
 
static _EIGEN_DECLARE_CONST_Packet4f_FROM_INT (minus_inf, 0xff800000)
 
static _EIGEN_DECLARE_CONST_Packet4f_FROM_INT (minus_nan, 0xffffffff)
 
static _EIGEN_DECLARE_CONST_Packet4i (0x7f, 0x7f)
 
static _EIGEN_DECLARE_CONST_Packet4i (23, 23)
 
template<typename T >
EIGEN_DEVICE_FUNC void aligned_delete (T *ptr, size_t size)
 
EIGEN_DEVICE_FUNC void aligned_free (void *ptr)
 
EIGEN_DEVICE_FUNC void * aligned_malloc (size_t size)
 
template<typename T >
EIGEN_DEVICE_FUNC T * aligned_new (size_t size)
 
void * aligned_realloc (void *ptr, size_t new_size, size_t old_size)
 
template<typename T >
amd_flip (const T &i)
 
template<typename T0 , typename T1 >
void amd_mark (const T0 *w, const T1 &j)
 
template<typename T0 , typename T1 >
bool amd_marked (const T0 *w, const T1 &j)
 
template<typename T >
amd_unflip (const T &i)
 
template<typename MatrixType , typename VectorsType , typename CoeffsType >
void apply_block_householder_on_the_left (MatrixType &mat, const VectorsType &vectors, const CoeffsType &hCoeffs, bool forward)
 
template<typename VectorX , typename VectorY , typename OtherScalar >
void apply_rotation_in_the_plane (DenseBase< VectorX > &xpr_x, DenseBase< VectorY > &xpr_y, const JacobiRotation< OtherScalar > &j)
 
template<typename DstXprType , typename SrcXprType >
void assign_sparse_to_sparse (DstXprType &dst, const SrcXprType &src)
 
template<typename MatrixType >
SluMatrix asSluMatrix (MatrixType &mat)
 
template<typename MatrixType , typename Rhs , typename Dest , typename Preconditioner >
bool bicgstab (const MatrixType &mat, const Rhs &rhs, Dest &x, const Preconditioner &precond, Index &iters, typename Dest::RealScalar &tol_error)
 
template<typename Derived >
NumTraits< typename traits< Derived >::Scalar >::Real blueNorm_impl (const EigenBase< Derived > &_vec)
 
template<typename Derived >
const Derived::Scalar bruteforce_det3_helper (const MatrixBase< Derived > &matrix, int a, int b, int c)
 
template<typename Derived >
const Derived::Scalar bruteforce_det4_helper (const MatrixBase< Derived > &matrix, int j, int k, int m, int n)
 
template<typename MatrixType >
void c_to_fortran_numbering (MatrixType &mat)
 
template<typename Dst , typename Src >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void call_assignment (Dst &dst, const Src &src)
 
template<typename Dst , typename Src >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void call_assignment (const Dst &dst, const Src &src)
 
template<typename Dst , typename Src , typename Func >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void call_assignment (Dst &dst, const Src &src, const Func &func, typename enable_if< evaluator_assume_aliasing< Src >::value, void *>::type=0)
 
template<typename Dst , typename Src , typename Func >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void call_assignment (Dst &dst, const Src &src, const Func &func, typename enable_if<!evaluator_assume_aliasing< Src >::value, void *>::type=0)
 
template<typename Dst , template< typename > class StorageBase, typename Src , typename Func >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void call_assignment (NoAlias< Dst, StorageBase > &dst, const Src &src, const Func &func)
 
template<typename Dst , typename Src , typename Func >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void call_assignment_no_alias (Dst &dst, const Src &src, const Func &func)
 
template<typename Dst , typename Src >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void call_assignment_no_alias (Dst &dst, const Src &src)
 
template<typename Dst , typename Src , typename Func >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void call_assignment_no_alias_no_transpose (Dst &dst, const Src &src, const Func &func)
 
template<typename Dst , typename Src >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void call_assignment_no_alias_no_transpose (Dst &dst, const Src &src)
 
template<typename DstXprType , typename SrcXprType , typename Functor >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void call_dense_assignment_loop (DstXprType &dst, const SrcXprType &src, const Functor &func)
 
template<typename DstXprType , typename SrcXprType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void call_dense_assignment_loop (DstXprType &dst, const SrcXprType &src)
 
template<int Mode, bool SetOpposite, typename DstXprType , typename SrcXprType , typename Functor >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void call_triangular_assignment_loop (DstXprType &dst, const SrcXprType &src, const Functor &func)
 
template<int Mode, bool SetOpposite, typename DstXprType , typename SrcXprType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void call_triangular_assignment_loop (DstXprType &dst, const SrcXprType &src)
 
static void check_DenseIndex_is_signed ()
 
template<typename Dst , typename Src >
void check_for_aliasing (const Dst &dst, const Src &src)
 
template<typename T >
EIGEN_DEVICE_FUNC EIGEN_ALWAYS_INLINE void check_size_for_overflow (size_t size)
 
template<typename T , int Size>
EIGEN_DEVICE_FUNC void check_static_allocation_size ()
 
EIGEN_DEVICE_FUNC void check_that_malloc_is_allowed ()
 
template<typename IndexType >
static IndexType clear_mark (IndexType n_row, Colamd_Row< IndexType > Row [])
 
template<typename MatrixType , int i, int j>
EIGEN_DEVICE_FUNC MatrixType::Scalar cofactor_3x3 (const MatrixType &m)
 
template<typename MatrixType , int i, int j>
EIGEN_DEVICE_FUNC MatrixType::Scalar cofactor_4x4 (const MatrixType &matrix)
 
template<typename IndexType >
static bool colamd (IndexType n_row, IndexType n_col, IndexType Alen, IndexType *A, IndexType *p, double knobs[COLAMD_KNOBS], IndexType stats[COLAMD_STATS])
 Computes a column ordering using the column approximate minimum degree ordering. More...
 
template<typename IndexType >
IndexType colamd_c (IndexType n_col)
 
template<typename IndexType >
IndexType colamd_r (IndexType n_row)
 
template<typename IndexType >
IndexType colamd_recommended (IndexType nnz, IndexType n_row, IndexType n_col)
 Returns the recommended value of Alen. More...
 
static void colamd_set_defaults (double knobs[COLAMD_KNOBS])
 set default parameters The use of this routine is optional. More...
 
template<typename MatrixType , typename IndexVector >
int coletree (const MatrixType &mat, IndexVector &parent, IndexVector &firstRowElt, typename MatrixType::StorageIndex *perm=0)
 
template<typename MatrixType , typename ResultType >
EIGEN_DEVICE_FUNC void compute_inverse_size2_helper (const MatrixType &matrix, const typename ResultType::Scalar &invdet, ResultType &result)
 
template<typename MatrixType , typename ResultType >
EIGEN_DEVICE_FUNC void compute_inverse_size3_helper (const MatrixType &matrix, const typename ResultType::Scalar &invdet, const Matrix< typename ResultType::Scalar, 3, 1 > &cofactors_col0, ResultType &result)
 
template<typename MatrixType , typename DiagType , typename SubDiagType >
ComputationInfo computeFromTridiagonal_impl (DiagType &diag, SubDiagType &subdiag, const Index maxIterations, bool computeEigenvectors, MatrixType &eivec)
 
template<typename LhsScalar , typename RhsScalar , int KcFactor, typename Index >
void computeProductBlockingSizes (Index &k, Index &m, Index &n, Index num_threads=1)
 Computes the blocking parameters for a m x k times k x n matrix product. More...
 
template<typename LhsScalar , typename RhsScalar , typename Index >
void computeProductBlockingSizes (Index &k, Index &m, Index &n, Index num_threads=1)
 
template<typename T , bool Align>
EIGEN_DEVICE_FUNC void conditional_aligned_delete (T *ptr, size_t size)
 
template<typename T , bool Align>
EIGEN_DEVICE_FUNC void conditional_aligned_delete_auto (T *ptr, size_t size)
 
template<bool Align>
EIGEN_DEVICE_FUNC void conditional_aligned_free (void *ptr)
 
template<>
EIGEN_DEVICE_FUNC void conditional_aligned_free< false > (void *ptr)
 
template<bool Align>
EIGEN_DEVICE_FUNC void * conditional_aligned_malloc (size_t size)
 
template<>
EIGEN_DEVICE_FUNC void * conditional_aligned_malloc< false > (size_t size)
 
template<typename T , bool Align>
EIGEN_DEVICE_FUNC T * conditional_aligned_new (size_t size)
 
template<typename T , bool Align>
EIGEN_DEVICE_FUNC T * conditional_aligned_new_auto (size_t size)
 
template<bool Align>
void * conditional_aligned_realloc (void *ptr, size_t new_size, size_t old_size)
 
template<>
void * conditional_aligned_realloc< false > (void *ptr, size_t new_size, size_t)
 
template<typename T , bool Align>
EIGEN_DEVICE_FUNC T * conditional_aligned_realloc_new (T *pts, size_t new_size, size_t old_size)
 
template<typename T , bool Align>
T * conditional_aligned_realloc_new_auto (T *pts, size_t new_size, size_t old_size)
 
template<typename MatrixType , typename Rhs , typename Dest , typename Preconditioner >
EIGEN_DONT_INLINE void conjugate_gradient (const MatrixType &mat, const Rhs &rhs, Dest &x, const Preconditioner &precond, Index &iters, typename Dest::RealScalar &tol_error)
 
template<typename Lhs , typename Rhs , typename ResultType >
static void conservative_sparse_sparse_product_impl (const Lhs &lhs, const Rhs &rhs, ResultType &res, bool sortedInsertion=false)
 
template<typename T >
EIGEN_DEVICE_FUNC T * const_cast_ptr (const T *ptr)
 
template<typename T >
EIGEN_DEVICE_FUNC T * construct_elements_of_array (T *ptr, size_t size)
 
template<typename IndexDest , typename IndexSrc >
EIGEN_DEVICE_FUNC IndexDest convert_index (const IndexSrc &idx)
 
bool copy_bool (bool b)
 
template<typename StorageIndex >
StorageIndex cs_tdfs (StorageIndex j, StorageIndex k, StorageIndex *head, const StorageIndex *next, StorageIndex *post, StorageIndex *stack)
 
template<typename StorageIndex >
static StorageIndex cs_wclear (StorageIndex mark, StorageIndex lemax, StorageIndex *w, StorageIndex n)
 
template<typename T >
EIGEN_DEVICE_FUNC void destruct_elements_of_array (T *ptr, size_t size)
 
template<typename IndexType >
static void detect_super_cols (colamd_col< IndexType > Col [], IndexType A [], IndexType head [], IndexType row_start, IndexType row_length)
 
 EIGEN_CATCH_ASSIGN_XPR_OP_PRODUCT (assign_op, scalar_sum_op, add_assign_op)
 
 EIGEN_CATCH_ASSIGN_XPR_OP_PRODUCT (add_assign_op, scalar_sum_op, add_assign_op)
 
 EIGEN_CATCH_ASSIGN_XPR_OP_PRODUCT (sub_assign_op, scalar_sum_op, sub_assign_op)
 
 EIGEN_CATCH_ASSIGN_XPR_OP_PRODUCT (assign_op, scalar_difference_op, sub_assign_op)
 
 EIGEN_CATCH_ASSIGN_XPR_OP_PRODUCT (add_assign_op, scalar_difference_op, sub_assign_op)
 
 EIGEN_CATCH_ASSIGN_XPR_OP_PRODUCT (sub_assign_op, scalar_difference_op, add_assign_op)
 
 EIGEN_MEMBER_FUNCTOR (squaredNorm, Size *NumTraits< Scalar >::MulCost+(Size-1) *NumTraits< Scalar >::AddCost)
 
 EIGEN_MEMBER_FUNCTOR (norm,(Size+5) *NumTraits< Scalar >::MulCost+(Size-1) *NumTraits< Scalar >::AddCost)
 
 EIGEN_MEMBER_FUNCTOR (stableNorm,(Size+5) *NumTraits< Scalar >::MulCost+(Size-1) *NumTraits< Scalar >::AddCost)
 
 EIGEN_MEMBER_FUNCTOR (blueNorm,(Size+5) *NumTraits< Scalar >::MulCost+(Size-1) *NumTraits< Scalar >::AddCost)
 
 EIGEN_MEMBER_FUNCTOR (hypotNorm,(Size-1) *functor_traits< scalar_hypot_op< Scalar > >::Cost)
 
 EIGEN_MEMBER_FUNCTOR (sum,(Size-1) *NumTraits< Scalar >::AddCost)
 
 EIGEN_MEMBER_FUNCTOR (mean,(Size-1) *NumTraits< Scalar >::AddCost+NumTraits< Scalar >::MulCost)
 
 EIGEN_MEMBER_FUNCTOR (minCoeff,(Size-1) *NumTraits< Scalar >::AddCost)
 
 EIGEN_MEMBER_FUNCTOR (maxCoeff,(Size-1) *NumTraits< Scalar >::AddCost)
 
 EIGEN_MEMBER_FUNCTOR (all,(Size-1) *NumTraits< Scalar >::AddCost)
 
 EIGEN_MEMBER_FUNCTOR (any,(Size-1) *NumTraits< Scalar >::AddCost)
 
 EIGEN_MEMBER_FUNCTOR (count,(Size-1) *NumTraits< Scalar >::AddCost)
 
 EIGEN_MEMBER_FUNCTOR (prod,(Size-1) *NumTraits< Scalar >::MulCost)
 
void eigen_pastix (pastix_data_t **pastix_data, int pastix_comm, int n, int *ptr, int *idx, float *vals, int *perm, int *invp, float *x, int nbrhs, int *iparm, double *dparm)
 
void eigen_pastix (pastix_data_t **pastix_data, int pastix_comm, int n, int *ptr, int *idx, double *vals, int *perm, int *invp, double *x, int nbrhs, int *iparm, double *dparm)
 
void eigen_pastix (pastix_data_t **pastix_data, int pastix_comm, int n, int *ptr, int *idx, std::complex< float > *vals, int *perm, int *invp, std::complex< float > *x, int nbrhs, int *iparm, double *dparm)
 
void eigen_pastix (pastix_data_t **pastix_data, int pastix_comm, int n, int *ptr, int *idx, std::complex< double > *vals, int *perm, int *invp, std::complex< double > *x, int nbrhs, int *iparm, double *dparm)
 
template<typename Index , typename IndexVector >
Index etree_find (Index i, IndexVector &pp)
 
template<typename LhsScalar , typename RhsScalar , int KcFactor, typename Index >
void evaluateProductBlockingSizesHeuristic (Index &k, Index &m, Index &n, Index num_threads=1)
 
template<typename T >
const T::Scalar * extract_data (const T &m)
 
template<typename IndexType >
static IndexType find_ordering (IndexType n_row, IndexType n_col, IndexType Alen, Colamd_Row< IndexType > Row [], colamd_col< IndexType > Col [], IndexType A [], IndexType head [], IndexType n_col2, IndexType max_deg, IndexType pfree)
 
template<int Alignment, typename Scalar , typename Index >
EIGEN_DEVICE_FUNC Index first_aligned (const Scalar *array, Index size)
 
template<int Alignment, typename Derived >
static Index first_aligned (const DenseBase< Derived > &m)
 
template<typename Scalar , typename Index >
EIGEN_DEVICE_FUNC Index first_default_aligned (const Scalar *array, Index size)
 
template<typename Derived >
static Index first_default_aligned (const DenseBase< Derived > &m)
 
template<typename Index >
Index first_multiple (Index size, Index base)
 
template<typename MatrixType >
void fortran_to_c_numbering (MatrixType &mat)
 
template<typename IndexType >
static IndexType garbage_collection (IndexType n_row, IndexType n_col, Colamd_Row< IndexType > Row [], colamd_col< IndexType > Col [], IndexType A [], IndexType *pfree)
 
template<typename CJ , typename A , typename B , typename C , typename T >
EIGEN_STRONG_INLINE void gebp_madd (const CJ &cj, A &a, B &b, C &c, T &t)
 
template<typename Derived >
EIGEN_DEVICE_FUNC const Derived::Scalar general_det3_helper (const MatrixBase< Derived > &matrix, int i1, int i2, int i3, int j1, int j2, int j3)
 
template<typename T >
generic_fast_tanh_float (const T &a_x)
 
void handmade_aligned_free (void *ptr)
 
void * handmade_aligned_malloc (std::size_t size)
 
void * handmade_aligned_realloc (void *ptr, std::size_t size, std::size_t=0)
 
template<typename MatrixQR , typename HCoeffs >
void householder_qr_inplace_unblocked (MatrixQR &mat, HCoeffs &hCoeffs, typename MatrixQR::Scalar *tempData=0)
 
template<typename T >
EIGEN_DEVICE_FUNC void ignore_unused_variable (const T &)
 
template<typename IndexType >
static IndexType init_rows_cols (IndexType n_row, IndexType n_col, Colamd_Row< IndexType > Row [], colamd_col< IndexType > col [], IndexType A [], IndexType p [], IndexType stats[COLAMD_STATS])
 
template<typename IndexType >
static void init_scoring (IndexType n_row, IndexType n_col, Colamd_Row< IndexType > Row [], colamd_col< IndexType > Col [], IndexType A [], IndexType head [], double knobs[COLAMD_KNOBS], IndexType *p_n_row2, IndexType *p_n_col2, IndexType *p_max_deg)
 
template<typename T1 , typename T2 >
bool is_same_dense (const T1 &mat1, const T2 &mat2, typename enable_if< has_direct_access< T1 >::ret &&has_direct_access< T2 >::ret, T1 >::type *=0)
 
template<typename T1 , typename T2 >
bool is_same_dense (const T1 &, const T2 &, typename enable_if<!(has_direct_access< T1 >::ret &&has_direct_access< T2 >::ret), T1 >::type *=0)
 
template<typename MatrixType , typename Rhs , typename Dest , typename Preconditioner >
EIGEN_DONT_INLINE void least_square_conjugate_gradient (const MatrixType &mat, const Rhs &rhs, Dest &x, const Preconditioner &precond, Index &iters, typename Dest::RealScalar &tol_error)
 
template<typename MatrixType , typename VectorType >
static Index llt_rank_update_lower (MatrixType &mat, const VectorType &vec, const typename MatrixType::RealScalar &sigma)
 
Index LUnumTempV (Index &m, Index &w, Index &t, Index &b)
 
template<typename Scalar >
Index LUTempSpace (Index &m, Index &w)
 
template<typename TriangularFactorType , typename VectorsType , typename CoeffsType >
void make_block_householder_triangular_factor (TriangularFactorType &triFactor, const VectorsType &vectors, const CoeffsType &hCoeffs)
 
void manage_caching_sizes (Action action, std::ptrdiff_t *l1, std::ptrdiff_t *l2, std::ptrdiff_t *l3)
 
std::ptrdiff_t manage_caching_sizes_helper (std::ptrdiff_t a, std::ptrdiff_t b)
 
void manage_multi_threading (Action action, int *v)
 
template<typename Scalar , int Flags, typename Index >
MappedSparseMatrix< Scalar, Flags, Indexmap_superlu (SluMatrix &sluMat)
 
template<typename Scalar , typename StorageIndex >
void minimum_degree_ordering (SparseMatrix< Scalar, ColMajor, StorageIndex > &C, PermutationMatrix< Dynamic, Dynamic, StorageIndex > &perm)
 
template<typename IndexVector >
void nr_etdfs (typename IndexVector::Scalar n, IndexVector &parent, IndexVector &first_kid, IndexVector &next_kid, IndexVector &post, typename IndexVector::Scalar postnum)
 
std::ostream & operator<< (std::ostream &s, const Packet16uc &v)
 
std::ostream & operator<< (std::ostream &s, const Packet4f &v)
 
std::ostream & operator<< (std::ostream &s, const Packet4i &v)
 
std::ostream & operator<< (std::ostream &s, const Packet4ui &v)
 
std::ostream & operator<< (std::ostream &s, const Packet2l &v)
 
std::ostream & operator<< (std::ostream &s, const Packet2ul &v)
 
std::ostream & operator<< (std::ostream &s, const Packet2d &v)
 
template<typename IndexType >
static void order_children (IndexType n_col, colamd_col< IndexType > Col [], IndexType p [])
 
template<typename MatrixType >
void ordering_helper_at_plus_a (const MatrixType &A, MatrixType &symmat)
 
template<typename Dst , typename Lhs , typename Rhs , typename Func >
void outer_product_selector_run (Dst &dst, const Lhs &lhs, const Rhs &rhs, const Func &func, const false_type &)
 
template<typename Dst , typename Lhs , typename Rhs , typename Func >
void outer_product_selector_run (Dst &dst, const Lhs &lhs, const Rhs &rhs, const Func &func, const true_type &)
 
uint32x2_t p2ui_CONJ_XOR ()
 
uint32x4_t p4ui_CONJ_XOR ()
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet pabs (const Packet &a)
 
template<>
EIGEN_STRONG_INLINE Packet8f pabs (const Packet8f &a)
 
template<>
EIGEN_STRONG_INLINE Packet4d pabs (const Packet4d &a)
 
template<>
EIGEN_STRONG_INLINE Packet2d pabs (const Packet2d &a)
 
template<>
EIGEN_STRONG_INLINE Packet4f pabs (const Packet4f &a)
 
template<>
EIGEN_STRONG_INLINE Packet4i pabs (const Packet4i &a)
 
template<>
EIGEN_STRONG_INLINE Packet16f pabs (const Packet16f &a)
 
template<>
EIGEN_STRONG_INLINE Packet8d pabs (const Packet8d &a)
 
template<>
EIGEN_STRONG_INLINE Packet2d pabs< Packet2d > (const Packet2d &a)
 
template<>
EIGEN_STRONG_INLINE Packet4f pabs< Packet4f > (const Packet4f &a)
 
template<>
EIGEN_STRONG_INLINE Packet4i pabs< Packet4i > (const Packet4i &a)
 
template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet pacos (const Packet &a)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet padd (const Packet &a, const Packet &b)
 
template<typename Packet >
DoublePacket< Packetpadd (const DoublePacket< Packet > &a, const DoublePacket< Packet > &b)
 
template<>
EIGEN_STRONG_INLINE Packet16f padd< Packet16f > (const Packet16f &a, const Packet16f &b)
 
template<>
EIGEN_STRONG_INLINE Packet1cd padd< Packet1cd > (const Packet1cd &a, const Packet1cd &b)
 
template<>
EIGEN_STRONG_INLINE Packet2cd padd< Packet2cd > (const Packet2cd &a, const Packet2cd &b)
 
template<>
EIGEN_STRONG_INLINE Packet2cf padd< Packet2cf > (const Packet2cf &a, const Packet2cf &b)
 
template<>
EIGEN_STRONG_INLINE Packet2d padd< Packet2d > (const Packet2d &a, const Packet2d &b)
 
template<>
EIGEN_STRONG_INLINE Packet4cf padd< Packet4cf > (const Packet4cf &a, const Packet4cf &b)
 
template<>
EIGEN_STRONG_INLINE Packet4d padd< Packet4d > (const Packet4d &a, const Packet4d &b)
 
template<>
EIGEN_STRONG_INLINE Packet4f padd< Packet4f > (const Packet4f &a, const Packet4f &b)
 
template<>
EIGEN_STRONG_INLINE Packet4i padd< Packet4i > (const Packet4i &a, const Packet4i &b)
 
template<>
EIGEN_STRONG_INLINE Packet8d padd< Packet8d > (const Packet8d &a, const Packet8d &b)
 
template<>
EIGEN_STRONG_INLINE Packet8f padd< Packet8f > (const Packet8f &a, const Packet8f &b)
 
template<int Offset, typename PacketType >
void palign (PacketType &first, const PacketType &second)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet pand (const Packet &a, const Packet &b)
 
template<>
EIGEN_STRONG_INLINE Packet16f pand< Packet16f > (const Packet16f &a, const Packet16f &b)
 
template<>
EIGEN_STRONG_INLINE Packet1cd pand< Packet1cd > (const Packet1cd &a, const Packet1cd &b)
 
template<>
EIGEN_STRONG_INLINE Packet2cd pand< Packet2cd > (const Packet2cd &a, const Packet2cd &b)
 
template<>
EIGEN_STRONG_INLINE Packet2cf pand< Packet2cf > (const Packet2cf &a, const Packet2cf &b)
 
template<>
EIGEN_STRONG_INLINE Packet2d pand< Packet2d > (const Packet2d &a, const Packet2d &b)
 
template<>
EIGEN_STRONG_INLINE Packet4cf pand< Packet4cf > (const Packet4cf &a, const Packet4cf &b)
 
template<>
EIGEN_STRONG_INLINE Packet4d pand< Packet4d > (const Packet4d &a, const Packet4d &b)
 
template<>
EIGEN_STRONG_INLINE Packet4f pand< Packet4f > (const Packet4f &a, const Packet4f &b)
 
template<>
EIGEN_STRONG_INLINE Packet4i pand< Packet4i > (const Packet4i &a, const Packet4i &b)
 
template<>
EIGEN_STRONG_INLINE Packet8d pand< Packet8d > (const Packet8d &a, const Packet8d &b)
 
template<>
EIGEN_STRONG_INLINE Packet8f pand< Packet8f > (const Packet8f &a, const Packet8f &b)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet pandnot (const Packet &a, const Packet &b)
 
template<>
EIGEN_STRONG_INLINE Packet16f pandnot< Packet16f > (const Packet16f &a, const Packet16f &b)
 
template<>
EIGEN_STRONG_INLINE Packet1cd pandnot< Packet1cd > (const Packet1cd &a, const Packet1cd &b)
 
template<>
EIGEN_STRONG_INLINE Packet2cd pandnot< Packet2cd > (const Packet2cd &a, const Packet2cd &b)
 
template<>
EIGEN_STRONG_INLINE Packet2cf pandnot< Packet2cf > (const Packet2cf &a, const Packet2cf &b)
 
template<>
EIGEN_STRONG_INLINE Packet2d pandnot< Packet2d > (const Packet2d &a, const Packet2d &b)
 
template<>
EIGEN_STRONG_INLINE Packet4cf pandnot< Packet4cf > (const Packet4cf &a, const Packet4cf &b)
 
template<>
EIGEN_STRONG_INLINE Packet4d pandnot< Packet4d > (const Packet4d &a, const Packet4d &b)
 
template<>
EIGEN_STRONG_INLINE Packet4f pandnot< Packet4f > (const Packet4f &a, const Packet4f &b)
 
template<>
EIGEN_STRONG_INLINE Packet4i pandnot< Packet4i > (const Packet4i &a, const Packet4i &b)
 
template<>
EIGEN_STRONG_INLINE Packet8d pandnot< Packet8d > (const Packet8d &a, const Packet8d &b)
 
template<>
EIGEN_STRONG_INLINE Packet8f pandnot< Packet8f > (const Packet8f &a, const Packet8f &b)
 
template<bool Condition, typename Functor , typename Index >
void parallelize_gemm (const Functor &func, Index rows, Index cols, Index depth, bool transpose)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet parg (const Packet &a)
 
template<typename MatrixType , typename TranspositionType >
void partial_lu_inplace (MatrixType &lu, TranspositionType &row_transpositions, typename TranspositionType::StorageIndex &nb_transpositions)
 
template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet pasin (const Packet &a)
 
template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet patan (const Packet &a)
 
template<>
EIGEN_STRONG_INLINE Packet2cf pblend (const Selector< 2 > &ifPacket, const Packet2cf &thenPacket, const Packet2cf &elsePacket)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet pblend (const Selector< unpacket_traits< Packet >::size > &ifPacket, const Packet &thenPacket, const Packet &elsePacket)
 
template<>
EIGEN_STRONG_INLINE Packet8f pblend (const Selector< 8 > &ifPacket, const Packet8f &thenPacket, const Packet8f &elsePacket)
 
template<>
EIGEN_STRONG_INLINE Packet4d pblend (const Selector< 4 > &ifPacket, const Packet4d &thenPacket, const Packet4d &elsePacket)
 
template<>
EIGEN_STRONG_INLINE Packet4i pblend (const Selector< 4 > &ifPacket, const Packet4i &thenPacket, const Packet4i &elsePacket)
 
template<>
EIGEN_STRONG_INLINE Packet4f pblend (const Selector< 4 > &ifPacket, const Packet4f &thenPacket, const Packet4f &elsePacket)
 
template<>
EIGEN_STRONG_INLINE Packet2d pblend (const Selector< 2 > &ifPacket, const Packet2d &thenPacket, const Packet2d &elsePacket)
 
template<>
EIGEN_STRONG_INLINE Packet16f pblend (const Selector< 16 > &, const Packet16f &, const Packet16f &)
 
template<>
EIGEN_STRONG_INLINE Packet8d pblend (const Selector< 8 > &, const Packet8d &, const Packet8d &)
 
template<typename Packet >
EIGEN_DEVICE_FUNC void pbroadcast2 (const typename unpacket_traits< Packet >::type *a, Packet &a0, Packet &a1)
 
template<typename Packet >
EIGEN_DEVICE_FUNC void pbroadcast4 (const typename unpacket_traits< Packet >::type *a, Packet &a0, Packet &a1, Packet &a2, Packet &a3)
 
template<>
EIGEN_STRONG_INLINE void pbroadcast4< Packet2d > (const double *a, Packet2d &a0, Packet2d &a1, Packet2d &a2, Packet2d &a3)
 
template<>
EIGEN_STRONG_INLINE void pbroadcast4< Packet4f > (const float *a, Packet4f &a0, Packet4f &a1, Packet4f &a2, Packet4f &a3)
 
template<>
EIGEN_STRONG_INLINE void pbroadcast4< Packet4i > (const int *a, Packet4i &a0, Packet4i &a1, Packet4i &a2, Packet4i &a3)
 
template<typename SrcPacket , typename TgtPacket >
EIGEN_DEVICE_FUNC TgtPacket pcast (const SrcPacket &a)
 
template<typename SrcPacket , typename TgtPacket >
EIGEN_DEVICE_FUNC TgtPacket pcast (const SrcPacket &a, const SrcPacket &)
 
template<typename SrcPacket , typename TgtPacket >
EIGEN_DEVICE_FUNC TgtPacket pcast (const SrcPacket &a, const SrcPacket &, const SrcPacket &, const SrcPacket &)
 
template<>
EIGEN_STRONG_INLINE Packet4f pcast< Packet2d, Packet4f > (const Packet2d &a, const Packet2d &b)
 
template<>
EIGEN_STRONG_INLINE Packet2d pcast< Packet4f, Packet2d > (const Packet4f &a)
 
template<>
EIGEN_STRONG_INLINE Packet4i pcast< Packet4f, Packet4i > (const Packet4f &a)
 
template<>
EIGEN_STRONG_INLINE Packet4f pcast< Packet4i, Packet4f > (const Packet4i &a)
 
template<>
EIGEN_STRONG_INLINE Packet8i pcast< Packet8f, Packet8i > (const Packet8f &a)
 
template<>
EIGEN_STRONG_INLINE Packet8f pcast< Packet8i, Packet8f > (const Packet8i &a)
 
template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet pceil (const Packet &a)
 
template<>
EIGEN_STRONG_INLINE Packet2d pceil< Packet2d > (const Packet2d &a)
 
template<>
EIGEN_STRONG_INLINE Packet4d pceil< Packet4d > (const Packet4d &a)
 
template<>
EIGEN_STRONG_INLINE Packet4f pceil< Packet4f > (const Packet4f &a)
 
template<>
EIGEN_STRONG_INLINE Packet8f pceil< Packet8f > (const Packet8f &a)
 
template<>
EIGEN_STRONG_INLINE Packet4cf pconj (const Packet4cf &a)
 
template<>
EIGEN_STRONG_INLINE Packet2cf pconj (const Packet2cf &a)
 
template<>
EIGEN_STRONG_INLINE Packet8f pconj (const Packet8f &a)
 
template<>
EIGEN_STRONG_INLINE Packet4d pconj (const Packet4d &a)
 
template<>
EIGEN_STRONG_INLINE Packet8i pconj (const Packet8i &a)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet pconj (const Packet &a)
 
template<>
EIGEN_STRONG_INLINE Packet16f pconj (const Packet16f &a)
 
template<>
EIGEN_STRONG_INLINE Packet8d pconj (const Packet8d &a)
 
template<>
EIGEN_STRONG_INLINE Packet16i pconj (const Packet16i &a)
 
template<>
EIGEN_STRONG_INLINE Packet2d pconj (const Packet2d &a)
 
template<>
EIGEN_STRONG_INLINE Packet2cd pconj (const Packet2cd &a)
 
template<>
EIGEN_STRONG_INLINE Packet1cd pconj (const Packet1cd &a)
 
template<>
EIGEN_STRONG_INLINE Packet4f pconj (const Packet4f &a)
 
template<>
EIGEN_STRONG_INLINE Packet4i pconj (const Packet4i &a)
 
template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet pcos (const Packet &a)
 
template<>
EIGEN_DEFINE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS EIGEN_UNUSED Packet4f pcos< Packet4f > (const Packet4f &_x)
 
template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet pcosh (const Packet &a)
 
EIGEN_STRONG_INLINE Packet2cf pcplxflip (const Packet2cf &x)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet pcplxflip (const Packet &a)
 
EIGEN_STRONG_INLINE Packet1cd pcplxflip (const Packet1cd &x)
 
template<>
EIGEN_STRONG_INLINE Packet2cd pcplxflip< Packet2cd > (const Packet2cd &x)
 
template<>
EIGEN_STRONG_INLINE Packet2cf pcplxflip< Packet2cf > (const Packet2cf &x)
 
template<>
EIGEN_STRONG_INLINE Packet4cf pcplxflip< Packet4cf > (const Packet4cf &x)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet pdiv (const Packet &a, const Packet &b)
 
template<>
EIGEN_STRONG_INLINE Packet16f pdiv< Packet16f > (const Packet16f &a, const Packet16f &b)
 
template<>
EIGEN_STRONG_INLINE Packet1cd pdiv< Packet1cd > (const Packet1cd &a, const Packet1cd &b)
 
template<>
EIGEN_STRONG_INLINE Packet2cd pdiv< Packet2cd > (const Packet2cd &a, const Packet2cd &b)
 
template<>
EIGEN_STRONG_INLINE Packet2cf pdiv< Packet2cf > (const Packet2cf &a, const Packet2cf &b)
 
template<>
EIGEN_STRONG_INLINE Packet2d pdiv< Packet2d > (const Packet2d &a, const Packet2d &b)
 
template<>
EIGEN_STRONG_INLINE Packet4cf pdiv< Packet4cf > (const Packet4cf &a, const Packet4cf &b)
 
template<>
EIGEN_STRONG_INLINE Packet4d pdiv< Packet4d > (const Packet4d &a, const Packet4d &b)
 
template<>
EIGEN_STRONG_INLINE Packet4f pdiv< Packet4f > (const Packet4f &a, const Packet4f &b)
 
template<>
EIGEN_STRONG_INLINE Packet4i pdiv< Packet4i > (const Packet4i &, const Packet4i &)
 
template<>
EIGEN_STRONG_INLINE Packet8d pdiv< Packet8d > (const Packet8d &a, const Packet8d &b)
 
template<>
EIGEN_STRONG_INLINE Packet8f pdiv< Packet8f > (const Packet8f &a, const Packet8f &b)
 
template<>
EIGEN_STRONG_INLINE Packet8i pdiv< Packet8i > (const Packet8i &, const Packet8i &)
 
template<int Mode, typename MatrixType , int DestOrder>
void permute_symm_to_fullsymm (const MatrixType &mat, SparseMatrix< typename MatrixType::Scalar, DestOrder, typename MatrixType::StorageIndex > &_dest, const typename MatrixType::StorageIndex *perm=0)
 
template<int SrcMode, int DstMode, typename MatrixType , int DestOrder>
void permute_symm_to_symm (const MatrixType &mat, SparseMatrix< typename MatrixType::Scalar, DestOrder, typename MatrixType::StorageIndex > &_dest, const typename MatrixType::StorageIndex *perm=0)
 
template<int _SrcMode, int _DstMode, typename MatrixType , int DstOrder>
void permute_symm_to_symm (const MatrixType &mat, SparseMatrix< typename MatrixType::Scalar, DstOrder, typename MatrixType::StorageIndex > &_dest, const typename MatrixType::StorageIndex *perm)
 
template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet pexp (const Packet &a)
 
template<>
EIGEN_DEFINE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS EIGEN_UNUSED Packet2d pexp< Packet2d > (const Packet2d &_x)
 
template<>
EIGEN_DEFINE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS EIGEN_UNUSED Packet4d pexp< Packet4d > (const Packet4d &_x)
 
template<>
EIGEN_DEFINE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS EIGEN_UNUSED Packet4f pexp< Packet4f > (const Packet4f &_x)
 
template<>
EIGEN_DEFINE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS EIGEN_UNUSED Packet8f pexp< Packet8f > (const Packet8f &_x)
 
template<typename Packet >
EIGEN_DEVICE_FUNC unpacket_traits< Packet >::type pfirst (const Packet &a)
 
template<>
EIGEN_STRONG_INLINE float pfirst< Packet16f > (const Packet16f &a)
 
template<>
EIGEN_STRONG_INLINE int pfirst< Packet16i > (const Packet16i &a)
 
template<>
EIGEN_STRONG_INLINE std::complex< double > pfirst< Packet1cd > (const Packet1cd &a)
 
template<>
EIGEN_STRONG_INLINE std::complex< double > pfirst< Packet2cd > (const Packet2cd &a)
 
template<>
EIGEN_STRONG_INLINE std::complex< float > pfirst< Packet2cf > (const Packet2cf &a)
 
template<>
EIGEN_STRONG_INLINE double pfirst< Packet2d > (const Packet2d &a)
 
template<>
EIGEN_STRONG_INLINE std::complex< float > pfirst< Packet4cf > (const Packet4cf &a)
 
template<>
EIGEN_STRONG_INLINE double pfirst< Packet4d > (const Packet4d &a)
 
template<>
EIGEN_STRONG_INLINE float pfirst< Packet4f > (const Packet4f &a)
 
template<>
EIGEN_STRONG_INLINE int pfirst< Packet4i > (const Packet4i &a)
 
template<>
EIGEN_STRONG_INLINE double pfirst< Packet8d > (const Packet8d &a)
 
template<>
EIGEN_STRONG_INLINE float pfirst< Packet8f > (const Packet8f &a)
 
template<>
EIGEN_STRONG_INLINE int pfirst< Packet8i > (const Packet8i &a)
 
template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet pfloor (const Packet &a)
 
template<>
EIGEN_STRONG_INLINE Packet2d pfloor< Packet2d > (const Packet2d &a)
 
template<>
EIGEN_STRONG_INLINE Packet4d pfloor< Packet4d > (const Packet4d &a)
 
template<>
EIGEN_STRONG_INLINE Packet4f pfloor< Packet4f > (const Packet4f &a)
 
template<>
EIGEN_STRONG_INLINE Packet8f pfloor< Packet8f > (const Packet8f &a)
 
template<typename Scalar , typename Packet >
EIGEN_DEVICE_FUNC Packet pgather (const Scalar *from, Index)
 
template<>
EIGEN_DEVICE_FUNC Packet2d pgather< double, Packet2d > (const double *from, Index stride)
 
template<>
EIGEN_DEVICE_FUNC Packet4d pgather< double, Packet4d > (const double *from, Index stride)
 
template<>
EIGEN_DEVICE_FUNC Packet8d pgather< double, Packet8d > (const double *from, Index stride)
 
template<>
EIGEN_DEVICE_FUNC Packet16f pgather< float, Packet16f > (const float *from, Index stride)
 
template<>
EIGEN_DEVICE_FUNC Packet4f pgather< float, Packet4f > (const float *from, Index stride)
 
template<>
EIGEN_DEVICE_FUNC Packet8f pgather< float, Packet8f > (const float *from, Index stride)
 
template<>
EIGEN_DEVICE_FUNC Packet4i pgather< int, Packet4i > (const int *from, Index stride)
 
template<>
EIGEN_DEVICE_FUNC Packet1cd pgather< std::complex< double >, Packet1cd > (const std::complex< double > *from, Index stride EIGEN_UNUSED)
 
template<>
EIGEN_DEVICE_FUNC Packet2cd pgather< std::complex< double >, Packet2cd > (const std::complex< double > *from, Index stride)
 
template<>
EIGEN_DEVICE_FUNC Packet2cf pgather< std::complex< float >, Packet2cf > (const std::complex< float > *from, Index stride)
 
template<>
EIGEN_DEVICE_FUNC Packet4cf pgather< std::complex< float >, Packet4cf > (const std::complex< float > *from, Index stride)
 
template<>
EIGEN_STRONG_INLINE Packet4cf pinsertfirst (const Packet4cf &a, std::complex< float > b)
 
template<>
EIGEN_STRONG_INLINE Packet2cd pinsertfirst (const Packet2cd &a, std::complex< double > b)
 
template<>
EIGEN_STRONG_INLINE Packet2cf pinsertfirst (const Packet2cf &a, std::complex< float > b)
 
template<>
EIGEN_STRONG_INLINE Packet1cd pinsertfirst (const Packet1cd &, std::complex< double > b)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet pinsertfirst (const Packet &a, typename unpacket_traits< Packet >::type b)
 
template<>
EIGEN_STRONG_INLINE Packet8f pinsertfirst (const Packet8f &a, float b)
 
template<>
EIGEN_STRONG_INLINE Packet4d pinsertfirst (const Packet4d &a, double b)
 
template<>
EIGEN_STRONG_INLINE Packet4f pinsertfirst (const Packet4f &a, float b)
 
template<>
EIGEN_STRONG_INLINE Packet2d pinsertfirst (const Packet2d &a, double b)
 
template<>
EIGEN_STRONG_INLINE Packet4cf pinsertlast (const Packet4cf &a, std::complex< float > b)
 
template<>
EIGEN_STRONG_INLINE Packet2cd pinsertlast (const Packet2cd &a, std::complex< double > b)
 
template<>
EIGEN_STRONG_INLINE Packet2cf pinsertlast (const Packet2cf &a, std::complex< float > b)
 
template<>
EIGEN_STRONG_INLINE Packet1cd pinsertlast (const Packet1cd &, std::complex< double > b)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet pinsertlast (const Packet &a, typename unpacket_traits< Packet >::type b)
 
template<>
EIGEN_STRONG_INLINE Packet8f pinsertlast (const Packet8f &a, float b)
 
template<>
EIGEN_STRONG_INLINE Packet4d pinsertlast (const Packet4d &a, double b)
 
template<>
EIGEN_STRONG_INLINE Packet4f pinsertlast (const Packet4f &a, float b)
 
template<>
EIGEN_STRONG_INLINE Packet2d pinsertlast (const Packet2d &a, double b)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet pload (const typename unpacket_traits< Packet >::type *from)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet pload1 (const typename unpacket_traits< Packet >::type *a)
 
template<>
EIGEN_STRONG_INLINE Packet16f pload1< Packet16f > (const float *from)
 
template<>
EIGEN_STRONG_INLINE Packet4d pload1< Packet4d > (const double *from)
 
template<>
EIGEN_STRONG_INLINE Packet8d pload1< Packet8d > (const double *from)
 
template<>
EIGEN_STRONG_INLINE Packet8f pload1< Packet8f > (const float *from)
 
template<>
EIGEN_STRONG_INLINE Packet16f pload< Packet16f > (const float *from)
 
template<>
EIGEN_STRONG_INLINE Packet16i pload< Packet16i > (const int *from)
 
template<>
EIGEN_STRONG_INLINE Packet1cd pload< Packet1cd > (const std::complex< double > *from)
 
template<>
EIGEN_STRONG_INLINE Packet2cd pload< Packet2cd > (const std::complex< double > *from)
 
template<>
EIGEN_STRONG_INLINE Packet2cf pload< Packet2cf > (const std::complex< float > *from)
 
template<>
EIGEN_STRONG_INLINE Packet2d pload< Packet2d > (const double *from)
 
template<>
EIGEN_STRONG_INLINE Packet4cf pload< Packet4cf > (const std::complex< float > *from)
 
template<>
EIGEN_STRONG_INLINE Packet4d pload< Packet4d > (const double *from)
 
template<>
EIGEN_STRONG_INLINE Packet4f pload< Packet4f > (const float *from)
 
template<>
EIGEN_STRONG_INLINE Packet4i pload< Packet4i > (const int *from)
 
template<>
EIGEN_STRONG_INLINE Packet8d pload< Packet8d > (const double *from)
 
template<>
EIGEN_STRONG_INLINE Packet8f pload< Packet8f > (const float *from)
 
template<>
EIGEN_STRONG_INLINE Packet8i pload< Packet8i > (const int *from)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet ploaddup (const typename unpacket_traits< Packet >::type *from)
 
template<>
EIGEN_STRONG_INLINE Packet16f ploaddup< Packet16f > (const float *from)
 
template<>
EIGEN_STRONG_INLINE Packet1cd ploaddup< Packet1cd > (const std::complex< double > *from)
 
template<>
EIGEN_STRONG_INLINE Packet2cd ploaddup< Packet2cd > (const std::complex< double > *from)
 
template<>
EIGEN_STRONG_INLINE Packet2cf ploaddup< Packet2cf > (const std::complex< float > *from)
 
template<>
EIGEN_STRONG_INLINE Packet2d ploaddup< Packet2d > (const double *from)
 
template<>
EIGEN_STRONG_INLINE Packet4cf ploaddup< Packet4cf > (const std::complex< float > *from)
 
template<>
EIGEN_STRONG_INLINE Packet4d ploaddup< Packet4d > (const double *from)
 
template<>
EIGEN_STRONG_INLINE Packet4f ploaddup< Packet4f > (const float *from)
 
template<>
EIGEN_STRONG_INLINE Packet4i ploaddup< Packet4i > (const int *from)
 
template<>
EIGEN_STRONG_INLINE Packet8d ploaddup< Packet8d > (const double *from)
 
template<>
EIGEN_STRONG_INLINE Packet8f ploaddup< Packet8f > (const float *from)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet ploadquad (const typename unpacket_traits< Packet >::type *from)
 
template<>
EIGEN_STRONG_INLINE Packet16f ploadquad< Packet16f > (const float *from)
 
template<>
EIGEN_STRONG_INLINE Packet8d ploadquad< Packet8d > (const double *from)
 
template<>
EIGEN_STRONG_INLINE Packet8f ploadquad< Packet8f > (const float *from)
 
template<typename Packet , int Alignment>
EIGEN_DEVICE_FUNC EIGEN_ALWAYS_INLINE Packet ploadt (const typename unpacket_traits< Packet >::type *from)
 
template<typename Packet , int LoadMode>
Packet ploadt_ro (const typename unpacket_traits< Packet >::type *from)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet ploadu (const typename unpacket_traits< Packet >::type *from)
 
template<>
EIGEN_STRONG_INLINE Packet16f ploadu< Packet16f > (const float *from)
 
template<>
EIGEN_STRONG_INLINE Packet16i ploadu< Packet16i > (const int *from)
 
template<>
EIGEN_STRONG_INLINE Packet1cd ploadu< Packet1cd > (const std::complex< double > *from)
 
template<>
EIGEN_STRONG_INLINE Packet2cd ploadu< Packet2cd > (const std::complex< double > *from)
 
template<>
EIGEN_STRONG_INLINE Packet2cf ploadu< Packet2cf > (const std::complex< float > *from)
 
template<>
EIGEN_STRONG_INLINE Packet2d ploadu< Packet2d > (const double *from)
 
template<>
EIGEN_STRONG_INLINE Packet4cf ploadu< Packet4cf > (const std::complex< float > *from)
 
template<>
EIGEN_STRONG_INLINE Packet4d ploadu< Packet4d > (const double *from)
 
template<>
EIGEN_STRONG_INLINE Packet4f ploadu< Packet4f > (const float *from)
 
template<>
EIGEN_STRONG_INLINE Packet4i ploadu< Packet4i > (const int *from)
 
template<>
EIGEN_STRONG_INLINE Packet8d ploadu< Packet8d > (const double *from)
 
template<>
EIGEN_STRONG_INLINE Packet8f ploadu< Packet8f > (const float *from)
 
template<>
EIGEN_STRONG_INLINE Packet8i ploadu< Packet8i > (const int *from)
 
template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet plog (const Packet &a)
 
template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet plog10 (const Packet &a)
 
template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet plog1p (const Packet &a)
 
template<>
EIGEN_DEFINE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS EIGEN_UNUSED Packet4f plog< Packet4f > (const Packet4f &_x)
 
template<>
EIGEN_DEFINE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS EIGEN_UNUSED Packet8f plog< Packet8f > (const Packet8f &_x)
 
template<typename Packet >
Packet plset (const typename unpacket_traits< Packet >::type &a)
 
template<>
EIGEN_STRONG_INLINE Packet16f plset< Packet16f > (const float &a)
 
template<>
EIGEN_STRONG_INLINE Packet2d plset< Packet2d > (const double &a)
 
template<>
EIGEN_STRONG_INLINE Packet4d plset< Packet4d > (const double &a)
 
template<>
EIGEN_STRONG_INLINE Packet4f plset< Packet4f > (const float &a)
 
template<>
EIGEN_STRONG_INLINE Packet4i plset< Packet4i > (const int &a)
 
template<>
EIGEN_STRONG_INLINE Packet8d plset< Packet8d > (const double &a)
 
template<>
EIGEN_STRONG_INLINE Packet8f plset< Packet8f > (const float &a)
 
template<>
EIGEN_STRONG_INLINE Packet4f pmadd (const Packet4f &a, const Packet4f &b, const Packet4f &c)
 
template<>
EIGEN_STRONG_INLINE Packet4i pmadd (const Packet4i &a, const Packet4i &b, const Packet4i &c)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet pmadd (const Packet &a, const Packet &b, const Packet &c)
 
template<>
EIGEN_STRONG_INLINE Packet2d pmadd (const Packet2d &a, const Packet2d &b, const Packet2d &c)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet pmax (const Packet &a, const Packet &b)
 
template<>
EIGEN_STRONG_INLINE Packet16f pmax< Packet16f > (const Packet16f &a, const Packet16f &b)
 
template<>
EIGEN_STRONG_INLINE Packet2d pmax< Packet2d > (const Packet2d &a, const Packet2d &b)
 
template<>
EIGEN_STRONG_INLINE Packet4d pmax< Packet4d > (const Packet4d &a, const Packet4d &b)
 
template<>
EIGEN_STRONG_INLINE Packet4f pmax< Packet4f > (const Packet4f &a, const Packet4f &b)
 
template<>
EIGEN_STRONG_INLINE Packet4i pmax< Packet4i > (const Packet4i &a, const Packet4i &b)
 
template<>
EIGEN_STRONG_INLINE Packet8d pmax< Packet8d > (const Packet8d &a, const Packet8d &b)
 
template<>
EIGEN_STRONG_INLINE Packet8f pmax< Packet8f > (const Packet8f &a, const Packet8f &b)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet pmin (const Packet &a, const Packet &b)
 
template<>
EIGEN_STRONG_INLINE Packet16f pmin< Packet16f > (const Packet16f &a, const Packet16f &b)
 
template<>
EIGEN_STRONG_INLINE Packet2d pmin< Packet2d > (const Packet2d &a, const Packet2d &b)
 
template<>
EIGEN_STRONG_INLINE Packet4d pmin< Packet4d > (const Packet4d &a, const Packet4d &b)
 
template<>
EIGEN_STRONG_INLINE Packet4f pmin< Packet4f > (const Packet4f &a, const Packet4f &b)
 
template<>
EIGEN_STRONG_INLINE Packet4i pmin< Packet4i > (const Packet4i &a, const Packet4i &b)
 
template<>
EIGEN_STRONG_INLINE Packet8d pmin< Packet8d > (const Packet8d &a, const Packet8d &b)
 
template<>
EIGEN_STRONG_INLINE Packet8f pmin< Packet8f > (const Packet8f &a, const Packet8f &b)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet pmul (const Packet &a, const Packet &b)
 
template<>
std::complex< float > pmul (const std::complex< float > &a, const std::complex< float > &b)
 
template<>
std::complex< double > pmul (const std::complex< double > &a, const std::complex< double > &b)
 
template<>
EIGEN_STRONG_INLINE Packet16f pmul< Packet16f > (const Packet16f &a, const Packet16f &b)
 
template<>
EIGEN_STRONG_INLINE Packet1cd pmul< Packet1cd > (const Packet1cd &a, const Packet1cd &b)
 
template<>
EIGEN_STRONG_INLINE Packet2cd pmul< Packet2cd > (const Packet2cd &a, const Packet2cd &b)
 
template<>
EIGEN_STRONG_INLINE Packet2cf pmul< Packet2cf > (const Packet2cf &a, const Packet2cf &b)
 
template<>
EIGEN_STRONG_INLINE Packet2d pmul< Packet2d > (const Packet2d &a, const Packet2d &b)
 
template<>
EIGEN_STRONG_INLINE Packet4cf pmul< Packet4cf > (const Packet4cf &a, const Packet4cf &b)
 
template<>
EIGEN_STRONG_INLINE Packet4d pmul< Packet4d > (const Packet4d &a, const Packet4d &b)
 
template<>
EIGEN_STRONG_INLINE Packet4f pmul< Packet4f > (const Packet4f &a, const Packet4f &b)
 
template<>
EIGEN_STRONG_INLINE Packet4i pmul< Packet4i > (const Packet4i &a, const Packet4i &b)
 
template<>
EIGEN_STRONG_INLINE Packet8d pmul< Packet8d > (const Packet8d &a, const Packet8d &b)
 
template<>
EIGEN_STRONG_INLINE Packet8f pmul< Packet8f > (const Packet8f &a, const Packet8f &b)
 
template<>
EIGEN_STRONG_INLINE Packet4cf pnegate (const Packet4cf &a)
 
template<>
EIGEN_STRONG_INLINE Packet2cf pnegate (const Packet2cf &a)
 
template<>
EIGEN_STRONG_INLINE Packet8f pnegate (const Packet8f &a)
 
template<>
EIGEN_STRONG_INLINE Packet4d pnegate (const Packet4d &a)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet pnegate (const Packet &a)
 
template<>
EIGEN_STRONG_INLINE Packet16f pnegate (const Packet16f &a)
 
template<>
EIGEN_STRONG_INLINE Packet8d pnegate (const Packet8d &a)
 
template<>
EIGEN_STRONG_INLINE Packet2d pnegate (const Packet2d &a)
 
template<>
EIGEN_STRONG_INLINE Packet2cd pnegate (const Packet2cd &a)
 
template<>
EIGEN_STRONG_INLINE Packet1cd pnegate (const Packet1cd &a)
 
template<>
EIGEN_STRONG_INLINE Packet4f pnegate (const Packet4f &a)
 
template<>
EIGEN_STRONG_INLINE Packet4i pnegate (const Packet4i &a)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet por (const Packet &a, const Packet &b)
 
template<>
EIGEN_STRONG_INLINE Packet16f por< Packet16f > (const Packet16f &a, const Packet16f &b)
 
template<>
EIGEN_STRONG_INLINE Packet1cd por< Packet1cd > (const Packet1cd &a, const Packet1cd &b)
 
template<>
EIGEN_STRONG_INLINE Packet2cd por< Packet2cd > (const Packet2cd &a, const Packet2cd &b)
 
template<>
EIGEN_STRONG_INLINE Packet2cf por< Packet2cf > (const Packet2cf &a, const Packet2cf &b)
 
template<>
EIGEN_STRONG_INLINE Packet2d por< Packet2d > (const Packet2d &a, const Packet2d &b)
 
template<>
EIGEN_STRONG_INLINE Packet4cf por< Packet4cf > (const Packet4cf &a, const Packet4cf &b)
 
template<>
EIGEN_STRONG_INLINE Packet4d por< Packet4d > (const Packet4d &a, const Packet4d &b)
 
template<>
EIGEN_STRONG_INLINE Packet4f por< Packet4f > (const Packet4f &a, const Packet4f &b)
 
template<>
EIGEN_STRONG_INLINE Packet4i por< Packet4i > (const Packet4i &a, const Packet4i &b)
 
template<>
EIGEN_STRONG_INLINE Packet8d por< Packet8d > (const Packet8d &a, const Packet8d &b)
 
template<>
EIGEN_STRONG_INLINE Packet8f por< Packet8f > (const Packet8f &a, const Packet8f &b)
 
template<typename Packet >
EIGEN_DEVICE_FUNC unpacket_traits< Packet >::type predux (const Packet &a)
 
template<>
EIGEN_STRONG_INLINE float predux< Packet16f > (const Packet16f &a)
 
template<>
EIGEN_STRONG_INLINE std::complex< double > predux< Packet1cd > (const Packet1cd &a)
 
template<>
EIGEN_STRONG_INLINE std::complex< double > predux< Packet2cd > (const Packet2cd &a)
 
template<>
EIGEN_STRONG_INLINE std::complex< float > predux< Packet2cf > (const Packet2cf &a)
 
template<>
EIGEN_STRONG_INLINE double predux< Packet2d > (const Packet2d &a)
 
template<>
EIGEN_STRONG_INLINE std::complex< float > predux< Packet4cf > (const Packet4cf &a)
 
template<>
EIGEN_STRONG_INLINE double predux< Packet4d > (const Packet4d &a)
 
template<>
EIGEN_STRONG_INLINE float predux< Packet4f > (const Packet4f &a)
 
template<>
EIGEN_STRONG_INLINE int predux< Packet4i > (const Packet4i &a)
 
template<>
EIGEN_STRONG_INLINE double predux< Packet8d > (const Packet8d &a)
 
template<>
EIGEN_STRONG_INLINE float predux< Packet8f > (const Packet8f &a)
 
template<typename Packet >
EIGEN_DEVICE_FUNC conditional<(unpacket_traits< Packet >::size%8)==0, typename unpacket_traits< Packet >::half, Packet >::type predux_downto4 (const Packet &a)
 
template<typename Packet >
const DoublePacket< Packet > & predux_downto4 (const DoublePacket< Packet > &a)
 
template<>
EIGEN_STRONG_INLINE Packet8f predux_downto4< Packet16f > (const Packet16f &a)
 
template<>
EIGEN_STRONG_INLINE Packet4d predux_downto4< Packet8d > (const Packet8d &a)
 
template<>
EIGEN_STRONG_INLINE Packet4f predux_downto4< Packet8f > (const Packet8f &a)
 
template<typename Packet >
EIGEN_DEVICE_FUNC unpacket_traits< Packet >::type predux_max (const Packet &a)
 
template<>
EIGEN_STRONG_INLINE float predux_max< Packet16f > (const Packet16f &a)
 
template<>
EIGEN_STRONG_INLINE double predux_max< Packet2d > (const Packet2d &a)
 
template<>
EIGEN_STRONG_INLINE double predux_max< Packet4d > (const Packet4d &a)
 
template<>
EIGEN_STRONG_INLINE float predux_max< Packet4f > (const Packet4f &a)
 
template<>
EIGEN_STRONG_INLINE int predux_max< Packet4i > (const Packet4i &a)
 
template<>
EIGEN_STRONG_INLINE double predux_max< Packet8d > (const Packet8d &a)
 
template<>
EIGEN_STRONG_INLINE float predux_max< Packet8f > (const Packet8f &a)
 
template<typename Packet >
EIGEN_DEVICE_FUNC unpacket_traits< Packet >::type predux_min (const Packet &a)
 
template<>
EIGEN_STRONG_INLINE float predux_min< Packet16f > (const Packet16f &a)
 
template<>
EIGEN_STRONG_INLINE double predux_min< Packet2d > (const Packet2d &a)
 
template<>
EIGEN_STRONG_INLINE double predux_min< Packet4d > (const Packet4d &a)
 
template<>
EIGEN_STRONG_INLINE float predux_min< Packet4f > (const Packet4f &a)
 
template<>
EIGEN_STRONG_INLINE int predux_min< Packet4i > (const Packet4i &a)
 
template<>
EIGEN_STRONG_INLINE double predux_min< Packet8d > (const Packet8d &a)
 
template<>
EIGEN_STRONG_INLINE float predux_min< Packet8f > (const Packet8f &a)
 
template<typename Packet >
EIGEN_DEVICE_FUNC unpacket_traits< Packet >::type predux_mul (const Packet &a)
 
template<>
EIGEN_STRONG_INLINE float predux_mul< Packet16f > (const Packet16f &a)
 
template<>
EIGEN_STRONG_INLINE std::complex< double > predux_mul< Packet1cd > (const Packet1cd &a)
 
template<>
EIGEN_STRONG_INLINE std::complex< double > predux_mul< Packet2cd > (const Packet2cd &a)
 
template<>
EIGEN_STRONG_INLINE std::complex< float > predux_mul< Packet2cf > (const Packet2cf &a)
 
template<>
EIGEN_STRONG_INLINE double predux_mul< Packet2d > (const Packet2d &a)
 
template<>
EIGEN_STRONG_INLINE std::complex< float > predux_mul< Packet4cf > (const Packet4cf &a)
 
template<>
EIGEN_STRONG_INLINE double predux_mul< Packet4d > (const Packet4d &a)
 
template<>
EIGEN_STRONG_INLINE float predux_mul< Packet4f > (const Packet4f &a)
 
template<>
EIGEN_STRONG_INLINE int predux_mul< Packet4i > (const Packet4i &a)
 
template<>
EIGEN_STRONG_INLINE double predux_mul< Packet8d > (const Packet8d &a)
 
template<>
EIGEN_STRONG_INLINE float predux_mul< Packet8f > (const Packet8f &a)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet preduxp (const Packet *vecs)
 
template<>
EIGEN_STRONG_INLINE Packet16f preduxp< Packet16f > (const Packet16f *vecs)
 
template<>
EIGEN_STRONG_INLINE Packet1cd preduxp< Packet1cd > (const Packet1cd *vecs)
 
template<>
EIGEN_STRONG_INLINE Packet2cd preduxp< Packet2cd > (const Packet2cd *vecs)
 
template<>
EIGEN_STRONG_INLINE Packet2cf preduxp< Packet2cf > (const Packet2cf *vecs)
 
template<>
EIGEN_STRONG_INLINE Packet2d preduxp< Packet2d > (const Packet2d *vecs)
 
template<>
EIGEN_STRONG_INLINE Packet4cf preduxp< Packet4cf > (const Packet4cf *vecs)
 
template<>
EIGEN_STRONG_INLINE Packet4d preduxp< Packet4d > (const Packet4d *vecs)
 
template<>
EIGEN_STRONG_INLINE Packet4f preduxp< Packet4f > (const Packet4f *vecs)
 
template<>
EIGEN_STRONG_INLINE Packet4i preduxp< Packet4i > (const Packet4i *vecs)
 
template<>
EIGEN_STRONG_INLINE Packet8d preduxp< Packet8d > (const Packet8d *vecs)
 
template<>
EIGEN_STRONG_INLINE Packet8f preduxp< Packet8f > (const Packet8f *vecs)
 
template<typename Scalar >
EIGEN_DEVICE_FUNC void prefetch (const Scalar *addr)
 
template<>
EIGEN_STRONG_INLINE void prefetch< double > (const double *addr)
 
template<>
EIGEN_STRONG_INLINE void prefetch< float > (const float *addr)
 
template<>
EIGEN_STRONG_INLINE void prefetch< int > (const int *addr)
 
template<>
EIGEN_STRONG_INLINE void prefetch< std::complex< double > > (const std::complex< double > *addr)
 
template<>
EIGEN_STRONG_INLINE void prefetch< std::complex< float > > (const std::complex< float > *addr)
 
template<>
EIGEN_STRONG_INLINE Packet4cf preverse (const Packet4cf &a)
 
template<>
EIGEN_STRONG_INLINE Packet2cf preverse (const Packet2cf &a)
 
template<>
EIGEN_STRONG_INLINE Packet8f preverse (const Packet8f &a)
 
template<>
EIGEN_STRONG_INLINE Packet4d preverse (const Packet4d &a)
 
template<>
EIGEN_STRONG_INLINE Packet2cd preverse (const Packet2cd &a)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet preverse (const Packet &a)
 
template<>
EIGEN_STRONG_INLINE Packet1cd preverse (const Packet1cd &a)
 
template<>
EIGEN_STRONG_INLINE Packet2d preverse (const Packet2d &a)
 
template<>
EIGEN_STRONG_INLINE Packet4f preverse (const Packet4f &a)
 
template<>
EIGEN_STRONG_INLINE Packet4i preverse (const Packet4i &a)
 
template<>
EIGEN_STRONG_INLINE Packet16f preverse (const Packet16f &a)
 
template<>
EIGEN_STRONG_INLINE Packet8d preverse (const Packet8d &a)
 
template<typename Derived >
std::ostream & print_matrix (std::ostream &s, const Derived &_m, const IOFormat &fmt)
 
template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet pround (const Packet &a)
 
template<>
EIGEN_STRONG_INLINE Packet2d pround< Packet2d > (const Packet2d &a)
 
template<>
EIGEN_STRONG_INLINE Packet4d pround< Packet4d > (const Packet4d &a)
 
template<>
EIGEN_STRONG_INLINE Packet4f pround< Packet4f > (const Packet4f &a)
 
template<>
EIGEN_STRONG_INLINE Packet8f pround< Packet8f > (const Packet8f &a)
 
template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet prsqrt (const Packet &a)
 
template<>
EIGEN_DEFINE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS EIGEN_UNUSED Packet2d prsqrt< Packet2d > (const Packet2d &x)
 
template<>
EIGEN_DEFINE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS EIGEN_UNUSED Packet4d prsqrt< Packet4d > (const Packet4d &x)
 
template<>
EIGEN_DEFINE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS EIGEN_UNUSED Packet4f prsqrt< Packet4f > (const Packet4f &x)
 
template<>
EIGEN_DEFINE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS EIGEN_UNUSED Packet8f prsqrt< Packet8f > (const Packet8f &x)
 
template<typename Scalar , typename Packet >
EIGEN_DEVICE_FUNC void pscatter (Scalar *to, const Packet &from, Index)
 
template<>
EIGEN_DEVICE_FUNC void pscatter< double, Packet2d > (double *to, const Packet2d &from, Index stride)
 
template<>
EIGEN_DEVICE_FUNC void pscatter< double, Packet4d > (double *to, const Packet4d &from, Index stride)
 
template<>
EIGEN_DEVICE_FUNC void pscatter< double, Packet8d > (double *to, const Packet8d &from, Index stride)
 
template<>
EIGEN_DEVICE_FUNC void pscatter< float, Packet16f > (float *to, const Packet16f &from, Index stride)
 
template<>
EIGEN_DEVICE_FUNC void pscatter< float, Packet4f > (float *to, const Packet4f &from, Index stride)
 
template<>
EIGEN_DEVICE_FUNC void pscatter< float, Packet8f > (float *to, const Packet8f &from, Index stride)
 
template<>
EIGEN_DEVICE_FUNC void pscatter< int, Packet4i > (int *to, const Packet4i &from, Index stride)
 
template<>
EIGEN_DEVICE_FUNC void pscatter< std::complex< double >, Packet1cd > (std::complex< double > *to, const Packet1cd &from, Index stride EIGEN_UNUSED)
 
template<>
EIGEN_DEVICE_FUNC void pscatter< std::complex< double >, Packet2cd > (std::complex< double > *to, const Packet2cd &from, Index stride)
 
template<>
EIGEN_DEVICE_FUNC void pscatter< std::complex< float >, Packet2cf > (std::complex< float > *to, const Packet2cf &from, Index stride)
 
template<>
EIGEN_DEVICE_FUNC void pscatter< std::complex< float >, Packet4cf > (std::complex< float > *to, const Packet4cf &from, Index stride)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet pset1 (const typename unpacket_traits< Packet >::type &a)
 
template<>
EIGEN_STRONG_INLINE Packet16f pset1< Packet16f > (const float &from)
 
template<>
EIGEN_STRONG_INLINE Packet16i pset1< Packet16i > (const int &from)
 
template<>
EIGEN_STRONG_INLINE Packet1cd pset1< Packet1cd > (const std::complex< double > &from)
 
template<>
EIGEN_STRONG_INLINE Packet2cd pset1< Packet2cd > (const std::complex< double > &from)
 
template<>
EIGEN_STRONG_INLINE Packet2cf pset1< Packet2cf > (const std::complex< float > &from)
 
template<>
EIGEN_STRONG_INLINE Packet2d pset1< Packet2d > (const double &from)
 
template<>
EIGEN_STRONG_INLINE Packet4cf pset1< Packet4cf > (const std::complex< float > &from)
 
template<>
EIGEN_STRONG_INLINE Packet4d pset1< Packet4d > (const double &from)
 
template<>
EIGEN_STRONG_INLINE Packet4f pset1< Packet4f > (const float &from)
 
template<>
EIGEN_STRONG_INLINE Packet4i pset1< Packet4i > (const int &from)
 
template<>
EIGEN_STRONG_INLINE Packet8d pset1< Packet8d > (const double &from)
 
template<>
EIGEN_STRONG_INLINE Packet8f pset1< Packet8f > (const float &from)
 
template<>
EIGEN_STRONG_INLINE Packet8i pset1< Packet8i > (const int &from)
 
Packet8i pshiftleft (Packet8i v, int n)
 
Packet8f pshiftright (Packet8f v, int n)
 
template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet psin (const Packet &a)
 
template<>
EIGEN_DEFINE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS EIGEN_UNUSED Packet4f psin< Packet4f > (const Packet4f &_x)
 
template<>
EIGEN_DEFINE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS EIGEN_UNUSED Packet8f psin< Packet8f > (const Packet8f &_x)
 
template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet psinh (const Packet &a)
 
template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet psqrt (const Packet &a)
 
template<>
EIGEN_DEFINE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS EIGEN_UNUSED Packet2d psqrt< Packet2d > (const Packet2d &x)
 
template<>
EIGEN_DEFINE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS EIGEN_UNUSED Packet4d psqrt< Packet4d > (const Packet4d &x)
 
template<>
EIGEN_DEFINE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS EIGEN_UNUSED Packet4f psqrt< Packet4f > (const Packet4f &x)
 
template<>
EIGEN_DEFINE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS EIGEN_UNUSED Packet8f psqrt< Packet8f > (const Packet8f &x)
 
template<typename Scalar , typename Packet >
EIGEN_DEVICE_FUNC void pstore (Scalar *to, const Packet &from)
 
template<typename Packet >
void pstore1 (typename unpacket_traits< Packet >::type *to, const typename unpacket_traits< Packet >::type &a)
 
template<>
EIGEN_STRONG_INLINE void pstore1< Packet16f > (float *to, const float &a)
 
template<>
EIGEN_STRONG_INLINE void pstore1< Packet16i > (int *to, const int &a)
 
template<>
EIGEN_STRONG_INLINE void pstore1< Packet2d > (double *to, const double &a)
 
template<>
EIGEN_STRONG_INLINE void pstore1< Packet4d > (double *to, const double &a)
 
template<>
EIGEN_STRONG_INLINE void pstore1< Packet4f > (float *to, const float &a)
 
template<>
EIGEN_STRONG_INLINE void pstore1< Packet8d > (double *to, const double &a)
 
template<>
EIGEN_STRONG_INLINE void pstore1< Packet8f > (float *to, const float &a)
 
template<>
EIGEN_STRONG_INLINE void pstore1< Packet8i > (int *to, const int &a)
 
template<>
EIGEN_STRONG_INLINE void pstore< double > (double *to, const Packet4d &from)
 
template<>
EIGEN_STRONG_INLINE void pstore< double > (double *to, const Packet2d &from)
 
template<>
EIGEN_STRONG_INLINE void pstore< double > (double *to, const Packet8d &from)
 
template<>
EIGEN_STRONG_INLINE void pstore< float > (float *to, const Packet8f &from)
 
template<>
EIGEN_STRONG_INLINE void pstore< float > (float *to, const Packet4f &from)
 
template<>
EIGEN_STRONG_INLINE void pstore< float > (float *to, const Packet16f &from)
 
template<>
EIGEN_STRONG_INLINE void pstore< int > (int *to, const Packet8i &from)
 
template<>
EIGEN_STRONG_INLINE void pstore< int > (int *to, const Packet4i &from)
 
template<>
EIGEN_STRONG_INLINE void pstore< int > (int *to, const Packet16i &from)
 
template<>
EIGEN_STRONG_INLINE void pstore< std::complex< double > > (std::complex< double > *to, const Packet2cd &from)
 
template<>
EIGEN_STRONG_INLINE void pstore< std::complex< double > > (std::complex< double > *to, const Packet1cd &from)
 
template<>
EIGEN_STRONG_INLINE void pstore< std::complex< float > > (std::complex< float > *to, const Packet2cf &from)
 
template<>
EIGEN_STRONG_INLINE void pstore< std::complex< float > > (std::complex< float > *to, const Packet4cf &from)
 
template<typename Scalar , typename Packet , int Alignment>
EIGEN_DEVICE_FUNC EIGEN_ALWAYS_INLINE void pstoret (Scalar *to, const Packet &from)
 
template<typename Scalar , typename Packet >
EIGEN_DEVICE_FUNC void pstoreu (Scalar *to, const Packet &from)
 
template<>
EIGEN_STRONG_INLINE void pstoreu< double > (double *to, const Packet4d &from)
 
template<>
EIGEN_STRONG_INLINE void pstoreu< double > (double *to, const Packet2d &from)
 
template<>
EIGEN_STRONG_INLINE void pstoreu< double > (double *to, const Packet8d &from)
 
template<>
EIGEN_STRONG_INLINE void pstoreu< float > (float *to, const Packet8f &from)
 
template<>
EIGEN_STRONG_INLINE void pstoreu< float > (float *to, const Packet4f &from)
 
template<>
EIGEN_STRONG_INLINE void pstoreu< float > (float *to, const Packet16f &from)
 
template<>
EIGEN_STRONG_INLINE void pstoreu< int > (int *to, const Packet8i &from)
 
template<>
EIGEN_STRONG_INLINE void pstoreu< int > (int *to, const Packet4i &from)
 
template<>
EIGEN_STRONG_INLINE void pstoreu< int > (int *to, const Packet16i &from)
 
template<>
EIGEN_STRONG_INLINE void pstoreu< std::complex< double > > (std::complex< double > *to, const Packet2cd &from)
 
template<>
EIGEN_STRONG_INLINE void pstoreu< std::complex< double > > (std::complex< double > *to, const Packet1cd &from)
 
template<>
EIGEN_STRONG_INLINE void pstoreu< std::complex< float > > (std::complex< float > *to, const Packet2cf &from)
 
template<>
EIGEN_STRONG_INLINE void pstoreu< std::complex< float > > (std::complex< float > *to, const Packet4cf &from)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet psub (const Packet &a, const Packet &b)
 
template<>
EIGEN_STRONG_INLINE Packet16f psub< Packet16f > (const Packet16f &a, const Packet16f &b)
 
template<>
EIGEN_STRONG_INLINE Packet1cd psub< Packet1cd > (const Packet1cd &a, const Packet1cd &b)
 
template<>
EIGEN_STRONG_INLINE Packet2cd psub< Packet2cd > (const Packet2cd &a, const Packet2cd &b)
 
template<>
EIGEN_STRONG_INLINE Packet2cf psub< Packet2cf > (const Packet2cf &a, const Packet2cf &b)
 
template<>
EIGEN_STRONG_INLINE Packet2d psub< Packet2d > (const Packet2d &a, const Packet2d &b)
 
template<>
EIGEN_STRONG_INLINE Packet4cf psub< Packet4cf > (const Packet4cf &a, const Packet4cf &b)
 
template<>
EIGEN_STRONG_INLINE Packet4d psub< Packet4d > (const Packet4d &a, const Packet4d &b)
 
template<>
EIGEN_STRONG_INLINE Packet4f psub< Packet4f > (const Packet4f &a, const Packet4f &b)
 
template<>
EIGEN_STRONG_INLINE Packet4i psub< Packet4i > (const Packet4i &a, const Packet4i &b)
 
template<>
EIGEN_STRONG_INLINE Packet8d psub< Packet8d > (const Packet8d &a, const Packet8d &b)
 
template<>
EIGEN_STRONG_INLINE Packet8f psub< Packet8f > (const Packet8f &a, const Packet8f &b)
 
template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet ptan (const Packet &a)
 
template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet ptanh (const Packet &a)
 
template<>
EIGEN_DEFINE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS EIGEN_UNUSED Packet4f ptanh< Packet4f > (const Packet4f &x)
 
template<>
EIGEN_DEFINE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS EIGEN_UNUSED Packet8f ptanh< Packet8f > (const Packet8f &x)
 
EIGEN_STRONG_INLINE void ptranspose (PacketBlock< Packet2cf, 2 > &kernel)
 
EIGEN_STRONG_INLINE void ptranspose (PacketBlock< Packet1cd, 2 > &kernel)
 
EIGEN_DEVICE_FUNC void ptranspose (PacketBlock< Packet4cf, 4 > &kernel)
 
EIGEN_DEVICE_FUNC void ptranspose (PacketBlock< Packet2cd, 2 > &kernel)
 
EIGEN_DEVICE_FUNC void ptranspose (PacketBlock< Packet8f, 8 > &kernel)
 
template<typename Packet >
EIGEN_DEVICE_FUNC void ptranspose (PacketBlock< Packet, 1 > &)
 
EIGEN_DEVICE_FUNC void ptranspose (PacketBlock< Packet8f, 4 > &kernel)
 
EIGEN_DEVICE_FUNC void ptranspose (PacketBlock< Packet4d, 4 > &kernel)
 
EIGEN_DEVICE_FUNC void ptranspose (PacketBlock< Packet4f, 4 > &kernel)
 
EIGEN_DEVICE_FUNC void ptranspose (PacketBlock< Packet4i, 4 > &kernel)
 
EIGEN_DEVICE_FUNC void ptranspose (PacketBlock< Packet2d, 2 > &kernel)
 
EIGEN_DEVICE_FUNC void ptranspose (PacketBlock< Packet16f, 16 > &kernel)
 
EIGEN_DEVICE_FUNC void ptranspose (PacketBlock< Packet16f, 4 > &kernel)
 
EIGEN_DEVICE_FUNC void ptranspose (PacketBlock< Packet8d, 4 > &kernel)
 
EIGEN_DEVICE_FUNC void ptranspose (PacketBlock< Packet8d, 8 > &kernel)
 
EIGEN_STRONG_INLINE void punpackp (Packet4f *vecs)
 
template<typename Packet >
EIGEN_DEVICE_FUNC Packet pxor (const Packet &a, const Packet &b)
 
template<>
EIGEN_STRONG_INLINE Packet16f pxor< Packet16f > (const Packet16f &a, const Packet16f &b)
 
template<>
EIGEN_STRONG_INLINE Packet1cd pxor< Packet1cd > (const Packet1cd &a, const Packet1cd &b)
 
template<>
EIGEN_STRONG_INLINE Packet2cd pxor< Packet2cd > (const Packet2cd &a, const Packet2cd &b)
 
template<>
EIGEN_STRONG_INLINE Packet2cf pxor< Packet2cf > (const Packet2cf &a, const Packet2cf &b)
 
template<>
EIGEN_STRONG_INLINE Packet2d pxor< Packet2d > (const Packet2d &a, const Packet2d &b)
 
template<>
EIGEN_STRONG_INLINE Packet4cf pxor< Packet4cf > (const Packet4cf &a, const Packet4cf &b)
 
template<>
EIGEN_STRONG_INLINE Packet4d pxor< Packet4d > (const Packet4d &a, const Packet4d &b)
 
template<>
EIGEN_STRONG_INLINE Packet4f pxor< Packet4f > (const Packet4f &a, const Packet4f &b)
 
template<>
EIGEN_STRONG_INLINE Packet4i pxor< Packet4i > (const Packet4i &a, const Packet4i &b)
 
template<>
EIGEN_STRONG_INLINE Packet8d pxor< Packet8d > (const Packet8d &a, const Packet8d &b)
 
template<>
EIGEN_STRONG_INLINE Packet8f pxor< Packet8f > (const Packet8f &a, const Packet8f &b)
 
void queryCacheSizes (int &l1, int &l2, int &l3)
 
int queryL1CacheSize ()
 
int queryTopLevelCacheSize ()
 
template<typename VectorV , typename VectorI >
Index QuickSplit (VectorV &row, VectorI &ind, Index ncut)
 
template<typename Decomposition >
Decomposition::RealScalar rcond_estimate_helper (typename Decomposition::RealScalar matrix_norm, const Decomposition &dec)
 Reciprocal condition number estimator. More...
 
template<typename Decomposition >
Decomposition::RealScalar rcond_invmatrix_L1_norm_estimate (const Decomposition &dec)
 
template<typename MatrixType , typename RealScalar , typename Index >
void real_2x2_jacobi_svd (const MatrixType &matrix, Index p, Index q, JacobiRotation< RealScalar > *j_left, JacobiRotation< RealScalar > *j_right)
 
template<typename T >
const T * return_ptr ()
 
template<typename InputIterator , typename SparseMatrixType , typename DupFunctor >
void set_from_triplets (const InputIterator &begin, const InputIterator &end, SparseMatrixType &mat, DupFunctor dup_func)
 
template<typename T >
EIGEN_DEVICE_FUNC void smart_copy (const T *start, const T *end, T *target)
 
template<typename T >
void smart_memmove (const T *start, const T *end, T *target)
 
template<typename Decomposition , typename Rhs , typename Dest >
enable_if< Rhs::ColsAtCompileTime!=1 &&Dest::ColsAtCompileTime!=1 >::type solve_sparse_through_dense_panels (const Decomposition &dec, const Rhs &rhs, Dest &dest)
 
template<typename Decomposition , typename Rhs , typename Dest >
enable_if< Rhs::ColsAtCompileTime==1||Dest::ColsAtCompileTime==1 >::type solve_sparse_through_dense_panels (const Decomposition &dec, const Rhs &rhs, Dest &dest)
 
template<int Mode, typename SparseLhsType , typename DenseRhsType , typename DenseResType , typename AlphaType >
void sparse_selfadjoint_time_dense_product (const SparseLhsType &lhs, const DenseRhsType &rhs, DenseResType &res, const AlphaType &alpha)
 
template<typename Lhs , typename Rhs , typename ResultType >
static void sparse_sparse_product_with_pruning_impl (const Lhs &lhs, const Rhs &rhs, ResultType &res, const typename ResultType::RealScalar &tolerance)
 
template<typename Lhs , typename Rhs , typename ResultType >
static void sparse_sparse_to_dense_product_impl (const Lhs &lhs, const Rhs &rhs, ResultType &res)
 
template<typename SparseLhsType , typename DenseRhsType , typename DenseResType , typename AlphaType >
void sparse_time_dense_product (const SparseLhsType &lhs, const DenseRhsType &rhs, DenseResType &res, const AlphaType &alpha)
 
template<typename Scalar >
EIGEN_DONT_INLINE void sparselu_gemm (Index m, Index n, Index d, const Scalar *A, Index lda, const Scalar *B, Index ldb, Scalar *C, Index ldc)
 
template<typename ExpressionType , typename Scalar >
void stable_norm_kernel (const ExpressionType &bl, Scalar &ssq, Scalar &scale, Scalar &invScale)
 
template<typename T >
void swap (scoped_array< T > &a, scoped_array< T > &b)
 
EIGEN_DEVICE_FUNC void throw_std_bad_alloc ()
 
template<typename Scalar , int Dim>
static EIGEN_DEVICE_FUNC Matrix< Scalar, 2, 2 > toRotationMatrix (const Scalar &s)
 
template<typename Scalar , int Dim, typename OtherDerived >
static EIGEN_DEVICE_FUNC Matrix< Scalar, Dim, Dim > toRotationMatrix (const RotationBase< OtherDerived, Dim > &r)
 
template<typename Scalar , int Dim, typename OtherDerived >
static EIGEN_DEVICE_FUNC const MatrixBase< OtherDerived > & toRotationMatrix (const MatrixBase< OtherDerived > &mat)
 
template<typename IndexVector >
void treePostorder (typename IndexVector::Scalar n, IndexVector &parent, IndexVector &post)
 Post order a tree. More...
 
template<int StorageOrder, typename RealScalar , typename Scalar , typename Index >
static EIGEN_DEVICE_FUNC void tridiagonal_qr_step (RealScalar *diag, RealScalar *subdiag, Index start, Index end, Scalar *matrixQ, Index n)
 
template<typename MatrixType , typename CoeffVectorType >
void tridiagonalization_inplace (MatrixType &matA, CoeffVectorType &hCoeffs)
 
template<typename MatrixType , typename DiagonalType , typename SubDiagonalType >
void tridiagonalization_inplace (MatrixType &mat, DiagonalType &diag, SubDiagonalType &subdiag, bool extractQ)
 Performs a full tridiagonalization in place. More...
 
template<typename MatrixType >
void upperbidiagonalization_blocked_helper (MatrixType &A, typename MatrixType::RealScalar *diagonal, typename MatrixType::RealScalar *upper_diagonal, Index bs, Ref< Matrix< typename MatrixType::Scalar, Dynamic, Dynamic, traits< MatrixType >::Flags &RowMajorBit > > X, Ref< Matrix< typename MatrixType::Scalar, Dynamic, Dynamic, traits< MatrixType >::Flags &RowMajorBit > > Y)
 
template<typename MatrixType , typename BidiagType >
void upperbidiagonalization_inplace_blocked (MatrixType &A, BidiagType &bidiagonal, Index maxBlockSize=32, typename MatrixType::Scalar *=0)
 
template<typename MatrixType >
void upperbidiagonalization_inplace_unblocked (MatrixType &mat, typename MatrixType::RealScalar *diagonal, typename MatrixType::RealScalar *upper_diagonal, typename MatrixType::Scalar *tempData=0)
 
template<typename Index >
bool useSpecificBlockingSizes (Index &k, Index &m, Index &n)
 
template<int element>
EIGEN_STRONG_INLINE Packet4f vec_splat_packet4f (const Packet4f &from)
 

Variables

const std::ptrdiff_t defaultL1CacheSize = 16*1024
 
const std::ptrdiff_t defaultL2CacheSize = 512*1024
 
const std::ptrdiff_t defaultL3CacheSize = 512*1024
 
static Packet16uc p16uc_COMPLEX32_REV = vec_sld(p16uc_REVERSE32, p16uc_REVERSE32, 8)
 
static Packet16uc p16uc_COMPLEX32_REV2 = vec_sld(p16uc_PSET64_HI, p16uc_PSET64_LO, 8)
 
static Packet16uc p16uc_DUPLICATE32_HI = { 0,1,2,3, 0,1,2,3, 4,5,6,7, 4,5,6,7 }
 
static Packet16uc p16uc_DUPLICATE32_HI = { 0,1,2,3, 0,1,2,3, 4,5,6,7, 4,5,6,7 }
 
static Packet16uc p16uc_FORWARD = p16uc_REVERSE32
 
static Packet16uc p16uc_FORWARD = { 0,1,2,3, 4,5,6,7, 8,9,10,11, 12,13,14,15 }
 
static Packet16uc p16uc_HALF64_0_16 = vec_sld(vec_splat((Packet16uc) vec_abs(p4i_MINUS16), 0), (Packet16uc)p4i_ZERO, 8)
 
static Packet16uc p16uc_PSET32_WEVEN = vec_sld((Packet16uc) vec_splat((Packet4ui)p16uc_FORWARD, 0), (Packet16uc) vec_splat((Packet4ui)p16uc_FORWARD, 2), 8)
 
static Packet16uc p16uc_PSET32_WEVEN = vec_sld(p16uc_DUPLICATE32_HI, (Packet16uc) vec_splat((Packet4ui)p16uc_FORWARD, 3), 8)
 
static Packet16uc p16uc_PSET32_WODD = vec_sld((Packet16uc) vec_splat((Packet4ui)p16uc_FORWARD, 1), (Packet16uc) vec_splat((Packet4ui)p16uc_FORWARD, 3), 8)
 
static Packet16uc p16uc_PSET32_WODD = vec_sld((Packet16uc) vec_splat((Packet4ui)p16uc_FORWARD, 0), (Packet16uc) vec_splat((Packet4ui)p16uc_FORWARD, 2), 8)
 
static Packet16uc p16uc_PSET64_HI = { 0,1,2,3, 4,5,6,7, 0,1,2,3, 4,5,6,7 }
 
static Packet16uc p16uc_PSET64_HI = (Packet16uc) vec_mergeh((Packet4ui)p16uc_PSET32_WODD, (Packet4ui)p16uc_PSET32_WEVEN)
 
static Packet16uc p16uc_PSET64_LO = (Packet16uc) vec_mergel((Packet4ui)p16uc_PSET32_WODD, (Packet4ui)p16uc_PSET32_WEVEN)
 
static Packet16uc p16uc_PSET64_LO = (Packet16uc) vec_mergel((Packet4ui)p16uc_PSET32_WODD, (Packet4ui)p16uc_PSET32_WEVEN)
 
static Packet16uc p16uc_REVERSE32 = { 12,13,14,15, 8,9,10,11, 4,5,6,7, 0,1,2,3 }
 
static Packet16uc p16uc_REVERSE32 = { 12,13,14,15, 8,9,10,11, 4,5,6,7, 0,1,2,3 }
 
static Packet16uc p16uc_REVERSE64 = { 8,9,10,11, 12,13,14,15, 0,1,2,3, 4,5,6,7 }
 
static Packet16uc p16uc_REVERSE64 = { 8,9,10,11, 12,13,14,15, 0,1,2,3, 4,5,6,7 }
 
static Packet16uc p16uc_TRANSPOSE64_HI = p16uc_PSET64_HI + p16uc_HALF64_0_16
 
static Packet16uc p16uc_TRANSPOSE64_HI = { 0,1,2,3, 4,5,6,7, 16,17,18,19, 20,21,22,23}
 
static Packet16uc p16uc_TRANSPOSE64_LO = p16uc_PSET64_LO + p16uc_HALF64_0_16
 
static Packet16uc p16uc_TRANSPOSE64_LO = { 8,9,10,11, 12,13,14,15, 24,25,26,27, 28,29,30,31}
 
static Packet2d p2d_COUNTDOWN = reinterpret_cast<Packet2d>(vec_sld(reinterpret_cast<Packet16uc>(p2d_ZERO), reinterpret_cast<Packet16uc>(p2d_ONE), 8))
 
static Packet2d p2d_ONE = { 1.0, 1.0 }
 
static Packet2d p2d_ZERO_ = { -0.0, -0.0 }
 
static Packet2ul p2ul_CONJ_XOR1 = (Packet2ul) vec_sld((Packet4ui) p2d_ZERO_, (Packet4ui) p2l_ZERO, 8)
 
static Packet2ul p2ul_CONJ_XOR2 = (Packet2ul) vec_sld((Packet4ui) p2l_ZERO, (Packet4ui) p2d_ZERO_, 8)
 
static Packet4f p4f_COUNTDOWN = { 0.0, 1.0, 2.0, 3.0 }
 
static Packet4f p4f_COUNTDOWN = { 0.0, 1.0, 2.0, 3.0 }
 
static Packet4f p4f_ONE = vec_ctf(p4i_ONE, 0)
 
static Packet4f p4f_ZERO_ = (Packet4f) vec_sl((Packet4ui)p4i_MINUS1, (Packet4ui)p4i_MINUS1)
 
static Packet4i p4i_COUNTDOWN = { 0, 1, 2, 3 }
 
static Packet4i p4i_COUNTDOWN = { 0, 1, 2, 3 }
 
static Packet4ui p4ui_CONJ_XOR = vec_mergeh((Packet4ui)p4i_ZERO, (Packet4ui)p4f_ZERO_)
 

Typedef Documentation

◆ IntPtr

typedef std::ptrdiff_t Eigen::internal::IntPtr

Definition at line 50 of file Meta.h.

◆ Packet16f

Definition at line 31 of file AVX512/PacketMath.h.

◆ Packet16i

typedef __m512i Eigen::internal::Packet16i

Definition at line 32 of file AVX512/PacketMath.h.

◆ Packet16uc

typedef __vector unsigned char Eigen::internal::Packet16uc

Definition at line 39 of file AltiVec/PacketMath.h.

◆ Packet2d

typedef __vector double Eigen::internal::Packet2d

Definition at line 57 of file SSE/PacketMath.h.

◆ Packet2f

typedef float32x2_t Eigen::internal::Packet2f

Definition at line 37 of file NEON/PacketMath.h.

◆ Packet2i

typedef int32x2_t Eigen::internal::Packet2i

Definition at line 40 of file NEON/PacketMath.h.

◆ Packet2l

typedef __vector long long Eigen::internal::Packet2l

Definition at line 42 of file ZVector/PacketMath.h.

◆ Packet2ul

typedef __vector unsigned long long Eigen::internal::Packet2ul

Definition at line 41 of file ZVector/PacketMath.h.

◆ Packet4bi

typedef __vector __bool int Eigen::internal::Packet4bi

Definition at line 37 of file AltiVec/PacketMath.h.

◆ Packet4d

typedef __m256d Eigen::internal::Packet4d

Definition at line 33 of file AVX/PacketMath.h.

◆ Packet4f

typedef __m128 Eigen::internal::Packet4f

Definition at line 34 of file AltiVec/PacketMath.h.

◆ Packet4i

typedef __vector int Eigen::internal::Packet4i

Definition at line 35 of file AltiVec/PacketMath.h.

◆ Packet4ui

typedef __vector unsigned int Eigen::internal::Packet4ui

Definition at line 36 of file AltiVec/PacketMath.h.

◆ Packet8d

typedef __m512d Eigen::internal::Packet8d

Definition at line 33 of file AVX512/PacketMath.h.

◆ Packet8f

typedef __m256 Eigen::internal::Packet8f

Definition at line 31 of file AVX/PacketMath.h.

◆ Packet8i

typedef __vector short int Eigen::internal::Packet8i

Definition at line 38 of file AltiVec/PacketMath.h.

◆ UIntPtr

typedef std::size_t Eigen::internal::UIntPtr

Definition at line 51 of file Meta.h.

Enumeration Type Documentation

◆ anonymous enum

anonymous enum
Enumerator
SDP_AsScalarProduct 
SDP_AsCwiseProduct 

Definition at line 29 of file SparseDiagonalProduct.h.

◆ anonymous enum

anonymous enum
Enumerator
SVA_RuntimeSwitch 
SVA_Inner 
SVA_Outer 

Definition at line 49 of file SparseVector.h.

◆ anonymous enum

anonymous enum
Enumerator
LUNoMarker 

Definition at line 37 of file SparseLU_Memory.h.

◆ anonymous enum

anonymous enum
Enumerator
emptyIdxLU 

Definition at line 38 of file SparseLU_Memory.h.

◆ anonymous enum

anonymous enum
Enumerator
PreconditionIfMoreColsThanRows 
PreconditionIfMoreRowsThanCols 

Definition at line 30 of file JacobiSVD.h.

◆ ComparisonName

Enumerator
cmp_EQ 
cmp_LT 
cmp_LE 
cmp_UNORD 
cmp_NEQ 
cmp_GT 
cmp_GE 

Definition at line 534 of file Constants.h.

◆ MemType

Enumerator
LUSUP 
UCOL 
LSUB 
USUB 
LLVL 
ULVL 

Definition at line 74 of file SparseLU_Structs.h.

◆ PermPermProduct_t

Enumerator
PermPermProduct 

Definition at line 18 of file PermutationMatrix.h.

◆ SignMatrix

Enumerator
PositiveSemiDef 
NegativeSemiDef 
ZeroSign 
Indefinite 

Definition at line 22 of file LDLT.h.

Function Documentation

◆ _EIGEN_DECLARE_CONST_FAST_Packet2d()

static Eigen::internal::_EIGEN_DECLARE_CONST_FAST_Packet2d ( ZERO  ,
 
)
static

◆ _EIGEN_DECLARE_CONST_FAST_Packet2l() [1/2]

static Eigen::internal::_EIGEN_DECLARE_CONST_FAST_Packet2l ( ZERO  ,
 
)
static

◆ _EIGEN_DECLARE_CONST_FAST_Packet2l() [2/2]

static Eigen::internal::_EIGEN_DECLARE_CONST_FAST_Packet2l ( ONE  ,
 
)
static

◆ _EIGEN_DECLARE_CONST_FAST_Packet4f()

static Eigen::internal::_EIGEN_DECLARE_CONST_FAST_Packet4f ( ZERO  ,
 
)
static

◆ _EIGEN_DECLARE_CONST_FAST_Packet4i() [1/5]

static Eigen::internal::_EIGEN_DECLARE_CONST_FAST_Packet4i ( ZERO  ,
 
)
static

◆ _EIGEN_DECLARE_CONST_FAST_Packet4i() [2/5]

static Eigen::internal::_EIGEN_DECLARE_CONST_FAST_Packet4i ( ONE  ,
 
)
static

◆ _EIGEN_DECLARE_CONST_FAST_Packet4i() [3/5]

static Eigen::internal::_EIGEN_DECLARE_CONST_FAST_Packet4i ( MINUS16  ,
16 
)
static

◆ _EIGEN_DECLARE_CONST_FAST_Packet4i() [4/5]

static Eigen::internal::_EIGEN_DECLARE_CONST_FAST_Packet4i ( MINUS1  ,
1 
)
static

◆ _EIGEN_DECLARE_CONST_FAST_Packet4i() [5/5]

static Eigen::internal::_EIGEN_DECLARE_CONST_FAST_Packet4i ( ONE  ,
 
)
static

◆ _EIGEN_DECLARE_CONST_Packet2d() [1/15]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet2d ( ,
1.  0 
)
static

◆ _EIGEN_DECLARE_CONST_Packet2d() [2/15]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet2d ( ,
2.  0 
)
static

◆ _EIGEN_DECLARE_CONST_Packet2d() [3/15]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet2d ( half  ,
0.  5 
)
static

◆ _EIGEN_DECLARE_CONST_Packet2d() [4/15]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet2d ( exp_hi  ,
709.  437 
)
static

◆ _EIGEN_DECLARE_CONST_Packet2d() [5/15]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet2d ( exp_lo  ,
-709.  436139303 
)
static

◆ _EIGEN_DECLARE_CONST_Packet2d() [6/15]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet2d ( cephes_LOG2EF  ,
1.  4426950408889634073599 
)
static

◆ _EIGEN_DECLARE_CONST_Packet2d() [7/15]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet2d ( cephes_exp_p0  ,
1.26177193074810590878e-  4 
)
static

◆ _EIGEN_DECLARE_CONST_Packet2d() [8/15]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet2d ( cephes_exp_p1  ,
3.02994407707441961300e-  2 
)
static

◆ _EIGEN_DECLARE_CONST_Packet2d() [9/15]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet2d ( cephes_exp_p2  ,
9.99999999999999999910e-  1 
)
static

◆ _EIGEN_DECLARE_CONST_Packet2d() [10/15]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet2d ( cephes_exp_q0  ,
3.00198505138664455042e-  6 
)
static

◆ _EIGEN_DECLARE_CONST_Packet2d() [11/15]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet2d ( cephes_exp_q1  ,
2.52448340349684104192e-  3 
)
static

◆ _EIGEN_DECLARE_CONST_Packet2d() [12/15]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet2d ( cephes_exp_q2  ,
2.27265548208155028766e-  1 
)
static

◆ _EIGEN_DECLARE_CONST_Packet2d() [13/15]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet2d ( cephes_exp_q3  ,
2.  00000000000000000009e0 
)
static

◆ _EIGEN_DECLARE_CONST_Packet2d() [14/15]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet2d ( cephes_exp_C1  ,
0.  693145751953125 
)
static

◆ _EIGEN_DECLARE_CONST_Packet2d() [15/15]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet2d ( cephes_exp_C2  ,
1.42860682030941723212e-  6 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [1/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( ,
1.  0f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [2/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( half  ,
0.  5f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [3/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( cephes_SQRTHF  ,
0.  707106781186547524f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [4/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( cephes_log_p0  ,
7.0376836292E-  2f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [5/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( cephes_log_p1  ,
- 1.1514610310E-  1f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [6/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( cephes_log_p2  ,
1.1676998740E-  1f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [7/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( cephes_log_p3  ,
- 1.2420140846E-  1f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [8/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( cephes_log_p4  ,
+1.4249322787E-  1f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [9/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( cephes_log_p5  ,
- 1.6668057665E-  1f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [10/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( cephes_log_p6  ,
+2.0000714765E-  1f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [11/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( cephes_log_p7  ,
- 2.4999993993E-  1f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [12/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( cephes_log_p8  ,
+3.3333331174E-  1f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [13/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( cephes_log_q1  ,
-2.12194440e-  4f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [14/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( cephes_log_q2  ,
0.  693359375f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [15/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( exp_hi  ,
88.  3762626647950f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [16/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( exp_lo  ,
-88.  3762626647949f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [17/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( cephes_LOG2EF  ,
1.  44269504088896341f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [18/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( cephes_exp_C1  ,
0.  693359375f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [19/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( cephes_exp_C2  ,
-2.12194440e-  4f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [20/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( cephes_exp_p0  ,
1.9875691500E-  4f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [21/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( cephes_exp_p1  ,
1.3981999507E-  3f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [22/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( cephes_exp_p2  ,
8.3334519073E-  3f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [23/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( cephes_exp_p3  ,
4.1665795894E-  2f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [24/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( cephes_exp_p4  ,
1.6666665459E-  1f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f() [25/25]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f ( cephes_exp_p5  ,
5.0000001201E-  1f 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f_FROM_INT() [1/4]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f_FROM_INT ( inv_mant_mask  ,
0x7f800000 
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f_FROM_INT() [2/4]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f_FROM_INT ( min_norm_pos  ,
0x00800000   
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f_FROM_INT() [3/4]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f_FROM_INT ( minus_inf  ,
0xff800000   
)
static

◆ _EIGEN_DECLARE_CONST_Packet4f_FROM_INT() [4/4]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4f_FROM_INT ( minus_nan  ,
0xffffffff   
)
static

◆ _EIGEN_DECLARE_CONST_Packet4i() [1/2]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4i ( 0x7f  ,
0x7f   
)
static

◆ _EIGEN_DECLARE_CONST_Packet4i() [2/2]

static Eigen::internal::_EIGEN_DECLARE_CONST_Packet4i ( 23  ,
23   
)
static

◆ aligned_delete()

template<typename T >
EIGEN_DEVICE_FUNC void Eigen::internal::aligned_delete ( T *  ptr,
size_t  size 
)
inline

Definition at line 331 of file Memory.h.

◆ aligned_free()

EIGEN_DEVICE_FUNC void Eigen::internal::aligned_free ( void *  ptr)
inline

Definition at line 174 of file Memory.h.

◆ aligned_malloc()

EIGEN_DEVICE_FUNC void* Eigen::internal::aligned_malloc ( size_t  size)
inline

Definition at line 153 of file Memory.h.

◆ aligned_new()

template<typename T >
EIGEN_DEVICE_FUNC T* Eigen::internal::aligned_new ( size_t  size)
inline

Definition at line 296 of file Memory.h.

◆ aligned_realloc()

void* Eigen::internal::aligned_realloc ( void *  ptr,
size_t  new_size,
size_t  old_size 
)
inline

Definition at line 188 of file Memory.h.

◆ amd_flip()

template<typename T >
T Eigen::internal::amd_flip ( const T &  i)
inline

Definition at line 38 of file Amd.h.

◆ amd_mark()

template<typename T0 , typename T1 >
void Eigen::internal::amd_mark ( const T0 *  w,
const T1 &  j 
)
inline

Definition at line 41 of file Amd.h.

◆ amd_marked()

template<typename T0 , typename T1 >
bool Eigen::internal::amd_marked ( const T0 *  w,
const T1 &  j 
)
inline

Definition at line 40 of file Amd.h.

◆ amd_unflip()

template<typename T >
T Eigen::internal::amd_unflip ( const T &  i)
inline

Definition at line 39 of file Amd.h.

◆ apply_block_householder_on_the_left()

template<typename MatrixType , typename VectorsType , typename CoeffsType >
void Eigen::internal::apply_block_householder_on_the_left ( MatrixType &  mat,
const VectorsType &  vectors,
const CoeffsType &  hCoeffs,
bool  forward 
)

Definition at line 79 of file BlockHouseholder.h.

◆ apply_rotation_in_the_plane()

template<typename VectorX , typename VectorY , typename OtherScalar >
void Eigen::internal::apply_rotation_in_the_plane ( DenseBase< VectorX > &  xpr_x,
DenseBase< VectorY > &  xpr_y,
const JacobiRotation< OtherScalar > &  j 
)

Applies the clock wise 2D rotation j to the set of 2D vectors of cordinates x and y: $ \left ( \begin{array}{cc} x \\ y \end{array} \right ) = J \left ( \begin{array}{cc} x \\ y \end{array} \right ) $

See also
MatrixBase::applyOnTheLeft(), MatrixBase::applyOnTheRight()

Definition at line 302 of file Jacobi.h.

◆ assign_sparse_to_sparse()

template<typename DstXprType , typename SrcXprType >
void Eigen::internal::assign_sparse_to_sparse ( DstXprType &  dst,
const SrcXprType &  src 
)

Definition at line 71 of file SparseAssign.h.

◆ asSluMatrix()

template<typename MatrixType >
SluMatrix Eigen::internal::asSluMatrix ( MatrixType &  mat)

Definition at line 291 of file SuperLUSupport.h.

◆ bicgstab()

template<typename MatrixType , typename Rhs , typename Dest , typename Preconditioner >
bool Eigen::internal::bicgstab ( const MatrixType &  mat,
const Rhs &  rhs,
Dest &  x,
const Preconditioner &  precond,
Index iters,
typename Dest::RealScalar &  tol_error 
)

Definition at line 29 of file BiCGSTAB.h.

◆ blueNorm_impl()

template<typename Derived >
NumTraits<typename traits<Derived>::Scalar>::Real Eigen::internal::blueNorm_impl ( const EigenBase< Derived > &  _vec)
inline

Definition at line 55 of file StableNorm.h.

◆ bruteforce_det3_helper()

template<typename Derived >
const Derived::Scalar Eigen::internal::bruteforce_det3_helper ( const MatrixBase< Derived > &  matrix,
int  a,
int  b,
int  c 
)
inline

Definition at line 19 of file Determinant.h.

◆ bruteforce_det4_helper()

template<typename Derived >
const Derived::Scalar Eigen::internal::bruteforce_det4_helper ( const MatrixBase< Derived > &  matrix,
int  j,
int  k,
int  m,
int  n 
)

Definition at line 27 of file Determinant.h.

◆ c_to_fortran_numbering()

template<typename MatrixType >
void Eigen::internal::c_to_fortran_numbering ( MatrixType &  mat)

Definition at line 97 of file PaStiXSupport.h.

◆ call_assignment() [1/5]

template<typename Dst , typename Src >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void Eigen::internal::call_assignment ( Dst &  dst,
const Src &  src 
)

Definition at line 763 of file AssignEvaluator.h.

◆ call_assignment() [2/5]

template<typename Dst , typename Src >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void Eigen::internal::call_assignment ( const Dst &  dst,
const Src &  src 
)

Definition at line 769 of file AssignEvaluator.h.

◆ call_assignment() [3/5]

template<typename Dst , typename Src , typename Func >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void Eigen::internal::call_assignment ( Dst &  dst,
const Src &  src,
const Func &  func,
typename enable_if< evaluator_assume_aliasing< Src >::value, void *>::type  = 0 
)

Definition at line 777 of file AssignEvaluator.h.

◆ call_assignment() [4/5]

template<typename Dst , typename Src , typename Func >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void Eigen::internal::call_assignment ( Dst &  dst,
const Src &  src,
const Func &  func,
typename enable_if<!evaluator_assume_aliasing< Src >::value, void *>::type  = 0 
)

Definition at line 785 of file AssignEvaluator.h.

◆ call_assignment() [5/5]

template<typename Dst , template< typename > class StorageBase, typename Src , typename Func >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void Eigen::internal::call_assignment ( NoAlias< Dst, StorageBase > &  dst,
const Src &  src,
const Func &  func 
)

Definition at line 794 of file AssignEvaluator.h.

◆ call_assignment_no_alias() [1/2]

template<typename Dst , typename Src , typename Func >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void Eigen::internal::call_assignment_no_alias ( Dst &  dst,
const Src &  src,
const Func &  func 
)

Definition at line 802 of file AssignEvaluator.h.

◆ call_assignment_no_alias() [2/2]

template<typename Dst , typename Src >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void Eigen::internal::call_assignment_no_alias ( Dst &  dst,
const Src &  src 
)

Definition at line 823 of file AssignEvaluator.h.

◆ call_assignment_no_alias_no_transpose() [1/2]

template<typename Dst , typename Src , typename Func >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void Eigen::internal::call_assignment_no_alias_no_transpose ( Dst &  dst,
const Src &  src,
const Func &  func 
)

Definition at line 830 of file AssignEvaluator.h.

◆ call_assignment_no_alias_no_transpose() [2/2]

template<typename Dst , typename Src >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void Eigen::internal::call_assignment_no_alias_no_transpose ( Dst &  dst,
const Src &  src 
)

Definition at line 841 of file AssignEvaluator.h.

◆ call_dense_assignment_loop() [1/2]

template<typename DstXprType , typename SrcXprType , typename Functor >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void Eigen::internal::call_dense_assignment_loop ( DstXprType &  dst,
const SrcXprType &  src,
const Functor &  func 
)

Definition at line 705 of file AssignEvaluator.h.

◆ call_dense_assignment_loop() [2/2]

template<typename DstXprType , typename SrcXprType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void Eigen::internal::call_dense_assignment_loop ( DstXprType &  dst,
const SrcXprType &  src 
)

Definition at line 728 of file AssignEvaluator.h.

◆ call_triangular_assignment_loop() [1/2]

template<int Mode, bool SetOpposite, typename DstXprType , typename SrcXprType , typename Functor >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void Eigen::internal::call_triangular_assignment_loop ( DstXprType &  dst,
const SrcXprType &  src,
const Functor &  func 
)

Definition at line 778 of file TriangularMatrix.h.

◆ call_triangular_assignment_loop() [2/2]

template<int Mode, bool SetOpposite, typename DstXprType , typename SrcXprType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void Eigen::internal::call_triangular_assignment_loop ( DstXprType &  dst,
const SrcXprType &  src 
)

Definition at line 806 of file TriangularMatrix.h.

◆ check_DenseIndex_is_signed()

static void Eigen::internal::check_DenseIndex_is_signed ( )
inlinestatic

Definition at line 20 of file DenseBase.h.

◆ check_for_aliasing()

template<typename Dst , typename Src >
void Eigen::internal::check_for_aliasing ( const Dst &  dst,
const Src &  src 
)

Definition at line 392 of file Transpose.h.

◆ check_size_for_overflow()

template<typename T >
EIGEN_DEVICE_FUNC EIGEN_ALWAYS_INLINE void Eigen::internal::check_size_for_overflow ( size_t  size)

Definition at line 286 of file Memory.h.

◆ check_static_allocation_size()

template<typename T , int Size>
EIGEN_DEVICE_FUNC void Eigen::internal::check_static_allocation_size ( )

Definition at line 29 of file DenseStorage.h.

◆ check_that_malloc_is_allowed()

EIGEN_DEVICE_FUNC void Eigen::internal::check_that_malloc_is_allowed ( )
inline

Definition at line 146 of file Memory.h.

◆ clear_mark()

template<typename IndexType >
static IndexType Eigen::internal::clear_mark ( IndexType  n_row,
Colamd_Row< IndexType >  Row[] 
)
inlinestatic

Definition at line 1821 of file Ordering.h.

◆ cofactor_3x3()

template<typename MatrixType , int i, int j>
EIGEN_DEVICE_FUNC MatrixType::Scalar Eigen::internal::cofactor_3x3 ( const MatrixType &  m)
inline

Definition at line 126 of file InverseImpl.h.

◆ cofactor_4x4()

template<typename MatrixType , int i, int j>
EIGEN_DEVICE_FUNC MatrixType::Scalar Eigen::internal::cofactor_4x4 ( const MatrixType &  matrix)
inline

Definition at line 213 of file InverseImpl.h.

◆ colamd()

template<typename IndexType >
static bool Eigen::internal::colamd ( IndexType  n_row,
IndexType  n_col,
IndexType  Alen,
IndexType *  A,
IndexType *  p,
double  knobs[COLAMD_KNOBS],
IndexType  stats[COLAMD_STATS] 
)
static

Computes a column ordering using the column approximate minimum degree ordering.

Computes a column ordering (Q) of A such that P(AQ)=LU or (AQ)'AQ=LL' have less fill-in and require fewer floating point operations than factorizing the unpermuted matrix A or A'A, respectively.

Parameters
n_rownumber of rows in A
n_colnumber of columns in A
Alen,sizeof the array A
Arow indices of the matrix, of size ALen
pcolumn pointers of A, of size n_col+1
knobsparameter settings for colamd
statscolamd output statistics and error codes

Definition at line 323 of file Ordering.h.

◆ colamd_c()

template<typename IndexType >
IndexType Eigen::internal::colamd_c ( IndexType  n_col)
inline

Definition at line 203 of file Ordering.h.

◆ colamd_r()

template<typename IndexType >
IndexType Eigen::internal::colamd_r ( IndexType  n_row)
inline

Definition at line 207 of file Ordering.h.

◆ colamd_recommended()

template<typename IndexType >
IndexType Eigen::internal::colamd_recommended ( IndexType  nnz,
IndexType  n_row,
IndexType  n_col 
)
inline

Returns the recommended value of Alen.

Returns recommended value of Alen for use by colamd. Returns -1 if any input argument is negative. The use of this routine or macro is optional. Note that the macro uses its arguments more than once, so be careful for side effects, if you pass expressions as arguments to COLAMD_RECOMMENDED.

Parameters
nnznonzeros in A
n_rownumber of rows in A
n_colnumber of columns in A
Returns
recommended value of Alen for use by colamd

Definition at line 258 of file Ordering.h.

◆ colamd_set_defaults()

static void Eigen::internal::colamd_set_defaults ( double  knobs[COLAMD_KNOBS])
inlinestatic

set default parameters The use of this routine is optional.

Colamd: rows with more than (knobs [COLAMD_DENSE_ROW] * n_col) entries are removed prior to ordering. Columns with more than (knobs [COLAMD_DENSE_COL] * n_row) entries are removed prior to ordering, and placed last in the output column ordering.

COLAMD_DENSE_ROW and COLAMD_DENSE_COL are defined as 0 and 1, respectively, in colamd.h. Default values of these two knobs are both 0.5. Currently, only knobs [0] and knobs [1] are used, but future versions may use more knobs. If so, they will be properly set to their defaults by the future version of colamd_set_defaults, so that the code that calls colamd will not need to change, assuming that you either use colamd_set_defaults, or pass a (double *) NULL pointer as the knobs array to colamd or symamd.

Parameters
knobsparameter settings for colamd

Definition at line 287 of file Ordering.h.

◆ coletree()

template<typename MatrixType , typename IndexVector >
int Eigen::internal::coletree ( const MatrixType &  mat,
IndexVector &  parent,
IndexVector &  firstRowElt,
typename MatrixType::StorageIndex *  perm = 0 
)

Compute the column elimination tree of a sparse matrix

Parameters
matThe matrix in column-major format.
parentThe elimination tree
firstRowEltThe column index of the first element in each row
permThe permutation to apply to the column of mat

Definition at line 61 of file SparseColEtree.h.

◆ compute_inverse_size2_helper()

template<typename MatrixType , typename ResultType >
EIGEN_DEVICE_FUNC void Eigen::internal::compute_inverse_size2_helper ( const MatrixType &  matrix,
const typename ResultType::Scalar &  invdet,
ResultType &  result 
)
inline

Definition at line 76 of file InverseImpl.h.

◆ compute_inverse_size3_helper()

template<typename MatrixType , typename ResultType >
EIGEN_DEVICE_FUNC void Eigen::internal::compute_inverse_size3_helper ( const MatrixType &  matrix,
const typename ResultType::Scalar &  invdet,
const Matrix< typename ResultType::Scalar, 3, 1 > &  cofactors_col0,
ResultType &  result 
)
inline

Definition at line 140 of file InverseImpl.h.

◆ computeFromTridiagonal_impl()

template<typename MatrixType , typename DiagType , typename SubDiagType >
ComputationInfo Eigen::internal::computeFromTridiagonal_impl ( DiagType &  diag,
SubDiagType &  subdiag,
const Index  maxIterations,
bool  computeEigenvectors,
MatrixType &  eivec 
)

Definition at line 481 of file SelfAdjointEigenSolver.h.

◆ computeProductBlockingSizes() [1/2]

template<typename LhsScalar , typename RhsScalar , int KcFactor, typename Index >
void Eigen::internal::computeProductBlockingSizes ( Index k,
Index m,
Index n,
Index  num_threads = 1 
)

Computes the blocking parameters for a m x k times k x n matrix product.

Parameters
[in,out]kInput: the third dimension of the product. Output: the blocking size along the same dimension.
[in,out]mInput: the number of rows of the left hand side. Output: the blocking size along the same dimension.
[in,out]nInput: the number of columns of the right hand side. Output: the blocking size along the same dimension.

Given a m x k times k x n matrix product of scalar types LhsScalar and RhsScalar, this function computes the blocking size parameters along the respective dimensions for matrix products and related algorithms.

The blocking size parameters may be evaluated:

  • either by a heuristic based on cache sizes;
  • or using fixed prescribed values (for testing purposes).
See also
setCpuCacheSizes

Definition at line 297 of file GeneralBlockPanelKernel.h.

◆ computeProductBlockingSizes() [2/2]

template<typename LhsScalar , typename RhsScalar , typename Index >
void Eigen::internal::computeProductBlockingSizes ( Index k,
Index m,
Index n,
Index  num_threads = 1 
)
inline

Definition at line 305 of file GeneralBlockPanelKernel.h.

◆ conditional_aligned_delete()

template<typename T , bool Align>
EIGEN_DEVICE_FUNC void Eigen::internal::conditional_aligned_delete ( T *  ptr,
size_t  size 
)
inline

Definition at line 340 of file Memory.h.

◆ conditional_aligned_delete_auto()

template<typename T , bool Align>
EIGEN_DEVICE_FUNC void Eigen::internal::conditional_aligned_delete_auto ( T *  ptr,
size_t  size 
)
inline

Definition at line 412 of file Memory.h.

◆ conditional_aligned_free()

template<bool Align>
EIGEN_DEVICE_FUNC void Eigen::internal::conditional_aligned_free ( void *  ptr)
inline

Definition at line 228 of file Memory.h.

◆ conditional_aligned_free< false >()

template<>
EIGEN_DEVICE_FUNC void Eigen::internal::conditional_aligned_free< false > ( void *  ptr)
inline

Definition at line 233 of file Memory.h.

◆ conditional_aligned_malloc()

template<bool Align>
EIGEN_DEVICE_FUNC void* Eigen::internal::conditional_aligned_malloc ( size_t  size)
inline

Definition at line 212 of file Memory.h.

◆ conditional_aligned_malloc< false >()

template<>
EIGEN_DEVICE_FUNC void* Eigen::internal::conditional_aligned_malloc< false > ( size_t  size)
inline

Definition at line 217 of file Memory.h.

◆ conditional_aligned_new()

template<typename T , bool Align>
EIGEN_DEVICE_FUNC T* Eigen::internal::conditional_aligned_new ( size_t  size)
inline

Definition at line 312 of file Memory.h.

◆ conditional_aligned_new_auto()

template<typename T , bool Align>
EIGEN_DEVICE_FUNC T* Eigen::internal::conditional_aligned_new_auto ( size_t  size)
inline

Definition at line 369 of file Memory.h.

◆ conditional_aligned_realloc()

template<bool Align>
void* Eigen::internal::conditional_aligned_realloc ( void *  ptr,
size_t  new_size,
size_t  old_size 
)
inline

Definition at line 238 of file Memory.h.

◆ conditional_aligned_realloc< false >()

template<>
void* Eigen::internal::conditional_aligned_realloc< false > ( void *  ptr,
size_t  new_size,
size_t   
)
inline

Definition at line 243 of file Memory.h.

◆ conditional_aligned_realloc_new()

template<typename T , bool Align>
EIGEN_DEVICE_FUNC T* Eigen::internal::conditional_aligned_realloc_new ( T *  pts,
size_t  new_size,
size_t  old_size 
)
inline

Definition at line 346 of file Memory.h.

◆ conditional_aligned_realloc_new_auto()

template<typename T , bool Align>
T* Eigen::internal::conditional_aligned_realloc_new_auto ( T *  pts,
size_t  new_size,
size_t  old_size 
)
inline

Definition at line 390 of file Memory.h.

◆ conjugate_gradient()

template<typename MatrixType , typename Rhs , typename Dest , typename Preconditioner >
EIGEN_DONT_INLINE void Eigen::internal::conjugate_gradient ( const MatrixType &  mat,
const Rhs &  rhs,
Dest &  x,
const Preconditioner &  precond,
Index iters,
typename Dest::RealScalar &  tol_error 
)

Definition at line 28 of file ConjugateGradient.h.

◆ conservative_sparse_sparse_product_impl()

template<typename Lhs , typename Rhs , typename ResultType >
static void Eigen::internal::conservative_sparse_sparse_product_impl ( const Lhs &  lhs,
const Rhs &  rhs,
ResultType &  res,
bool  sortedInsertion = false 
)
static

Definition at line 18 of file ConservativeSparseSparseProduct.h.

◆ const_cast_ptr()

template<typename T >
EIGEN_DEVICE_FUNC T* Eigen::internal::const_cast_ptr ( const T *  ptr)
inline

Definition at line 457 of file XprHelper.h.

◆ construct_elements_of_array()

template<typename T >
EIGEN_DEVICE_FUNC T* Eigen::internal::construct_elements_of_array ( T *  ptr,
size_t  size 
)
inline

Definition at line 265 of file Memory.h.

◆ convert_index()

template<typename IndexDest , typename IndexSrc >
EIGEN_DEVICE_FUNC IndexDest Eigen::internal::convert_index ( const IndexSrc &  idx)
inline

Definition at line 31 of file XprHelper.h.

◆ copy_bool()

bool Eigen::internal::copy_bool ( bool  b)
inline

Definition at line 543 of file Macros.h.

◆ cs_tdfs()

template<typename StorageIndex >
StorageIndex Eigen::internal::cs_tdfs ( StorageIndex  j,
StorageIndex  k,
StorageIndex *  head,
const StorageIndex *  next,
StorageIndex *  post,
StorageIndex *  stack 
)

Definition at line 60 of file Amd.h.

◆ cs_wclear()

template<typename StorageIndex >
static StorageIndex Eigen::internal::cs_wclear ( StorageIndex  mark,
StorageIndex  lemax,
StorageIndex *  w,
StorageIndex  n 
)
static

Definition at line 45 of file Amd.h.

◆ destruct_elements_of_array()

template<typename T >
EIGEN_DEVICE_FUNC void Eigen::internal::destruct_elements_of_array ( T *  ptr,
size_t  size 
)
inline

Definition at line 255 of file Memory.h.

◆ detect_super_cols()

template<typename IndexType >
static void Eigen::internal::detect_super_cols ( colamd_col< IndexType >  Col[],
IndexType  A[],
IndexType  head[],
IndexType  row_start,
IndexType  row_length 
)
static

Definition at line 1549 of file Ordering.h.

◆ EIGEN_CATCH_ASSIGN_XPR_OP_PRODUCT() [1/6]

Eigen::internal::EIGEN_CATCH_ASSIGN_XPR_OP_PRODUCT ( assign_op  ,
scalar_sum_op  ,
add_assign_op   
)

◆ EIGEN_CATCH_ASSIGN_XPR_OP_PRODUCT() [2/6]

Eigen::internal::EIGEN_CATCH_ASSIGN_XPR_OP_PRODUCT ( add_assign_op  ,
scalar_sum_op  ,
add_assign_op   
)

◆ EIGEN_CATCH_ASSIGN_XPR_OP_PRODUCT() [3/6]

Eigen::internal::EIGEN_CATCH_ASSIGN_XPR_OP_PRODUCT ( sub_assign_op  ,
scalar_sum_op  ,
sub_assign_op   
)

◆ EIGEN_CATCH_ASSIGN_XPR_OP_PRODUCT() [4/6]

Eigen::internal::EIGEN_CATCH_ASSIGN_XPR_OP_PRODUCT ( assign_op  ,
scalar_difference_op  ,
sub_assign_op   
)

◆ EIGEN_CATCH_ASSIGN_XPR_OP_PRODUCT() [5/6]

Eigen::internal::EIGEN_CATCH_ASSIGN_XPR_OP_PRODUCT ( add_assign_op  ,
scalar_difference_op  ,
sub_assign_op   
)

◆ EIGEN_CATCH_ASSIGN_XPR_OP_PRODUCT() [6/6]

Eigen::internal::EIGEN_CATCH_ASSIGN_XPR_OP_PRODUCT ( sub_assign_op  ,
scalar_difference_op  ,
add_assign_op   
)

◆ EIGEN_MEMBER_FUNCTOR() [1/13]

Eigen::internal::EIGEN_MEMBER_FUNCTOR ( squaredNorm  ,
Size *NumTraits< Scalar >::MulCost+(Size-1) *NumTraits< Scalar >::AddCost   
)

◆ EIGEN_MEMBER_FUNCTOR() [2/13]

Eigen::internal::EIGEN_MEMBER_FUNCTOR ( norm  ,
(Size+5) *NumTraits< Scalar >::MulCost+(Size-1) *NumTraits< Scalar >::AddCost   
)

◆ EIGEN_MEMBER_FUNCTOR() [3/13]

Eigen::internal::EIGEN_MEMBER_FUNCTOR ( stableNorm  ,
(Size+5) *NumTraits< Scalar >::MulCost+(Size-1) *NumTraits< Scalar >::AddCost   
)

◆ EIGEN_MEMBER_FUNCTOR() [4/13]

Eigen::internal::EIGEN_MEMBER_FUNCTOR ( blueNorm  ,
(Size+5) *NumTraits< Scalar >::MulCost+(Size-1) *NumTraits< Scalar >::AddCost   
)

◆ EIGEN_MEMBER_FUNCTOR() [5/13]

Eigen::internal::EIGEN_MEMBER_FUNCTOR ( hypotNorm  ,
(Size-1) *functor_traits< scalar_hypot_op< Scalar > >::Cost   
)

◆ EIGEN_MEMBER_FUNCTOR() [6/13]

Eigen::internal::EIGEN_MEMBER_FUNCTOR ( sum  ,
(Size-1) *NumTraits< Scalar >::AddCost   
)

◆ EIGEN_MEMBER_FUNCTOR() [7/13]

Eigen::internal::EIGEN_MEMBER_FUNCTOR ( mean  ,
(Size-1) *NumTraits< Scalar >::AddCost+NumTraits< Scalar >::MulCost   
)

◆ EIGEN_MEMBER_FUNCTOR() [8/13]

Eigen::internal::EIGEN_MEMBER_FUNCTOR ( minCoeff  ,
(Size-1) *NumTraits< Scalar >::AddCost   
)

◆ EIGEN_MEMBER_FUNCTOR() [9/13]

Eigen::internal::EIGEN_MEMBER_FUNCTOR ( maxCoeff  ,
(Size-1) *NumTraits< Scalar >::AddCost   
)

◆ EIGEN_MEMBER_FUNCTOR() [10/13]

Eigen::internal::EIGEN_MEMBER_FUNCTOR ( all  ,
(Size-1) *NumTraits< Scalar >::AddCost   
)

◆ EIGEN_MEMBER_FUNCTOR() [11/13]

Eigen::internal::EIGEN_MEMBER_FUNCTOR ( any  ,
(Size-1) *NumTraits< Scalar >::AddCost   
)

◆ EIGEN_MEMBER_FUNCTOR() [12/13]

Eigen::internal::EIGEN_MEMBER_FUNCTOR ( count  ,
(Size-1) *NumTraits< Scalar >::AddCost   
)

◆ EIGEN_MEMBER_FUNCTOR() [13/13]

Eigen::internal::EIGEN_MEMBER_FUNCTOR ( prod  ,
(Size-1) *NumTraits< Scalar >::MulCost   
)

◆ eigen_pastix() [1/4]

void Eigen::internal::eigen_pastix ( pastix_data_t **  pastix_data,
int  pastix_comm,
int  n,
int *  ptr,
int *  idx,
float *  vals,
int *  perm,
int *  invp,
float *  x,
int  nbrhs,
int *  iparm,
double *  dparm 
)

Definition at line 67 of file PaStiXSupport.h.

◆ eigen_pastix() [2/4]

void Eigen::internal::eigen_pastix ( pastix_data_t **  pastix_data,
int  pastix_comm,
int  n,
int *  ptr,
int *  idx,
double *  vals,
int *  perm,
int *  invp,
double *  x,
int  nbrhs,
int *  iparm,
double *  dparm 
)

Definition at line 74 of file PaStiXSupport.h.

◆ eigen_pastix() [3/4]

void Eigen::internal::eigen_pastix ( pastix_data_t **  pastix_data,
int  pastix_comm,
int  n,
int *  ptr,
int *  idx,
std::complex< float > *  vals,
int *  perm,
int *  invp,
std::complex< float > *  x,
int  nbrhs,
int *  iparm,
double *  dparm 
)

Definition at line 81 of file PaStiXSupport.h.

◆ eigen_pastix() [4/4]

void Eigen::internal::eigen_pastix ( pastix_data_t **  pastix_data,
int  pastix_comm,
int  n,
int *  ptr,
int *  idx,
std::complex< double > *  vals,
int *  perm,
int *  invp,
std::complex< double > *  x,
int  nbrhs,
int *  iparm,
double *  dparm 
)

Definition at line 88 of file PaStiXSupport.h.

◆ etree_find()

template<typename Index , typename IndexVector >
Index Eigen::internal::etree_find ( Index  i,
IndexVector &  pp 
)

Find the root of the tree/set containing the vertex i : Use Path halving

Definition at line 40 of file SparseColEtree.h.

◆ evaluateProductBlockingSizesHeuristic()

template<typename LhsScalar , typename RhsScalar , int KcFactor, typename Index >
void Eigen::internal::evaluateProductBlockingSizesHeuristic ( Index k,
Index m,
Index n,
Index  num_threads = 1 
)

Definition at line 93 of file GeneralBlockPanelKernel.h.

◆ extract_data()

template<typename T >
const T::Scalar* Eigen::internal::extract_data ( const T &  m)

Definition at line 389 of file BlasUtil.h.

◆ find_ordering()

template<typename IndexType >
static IndexType Eigen::internal::find_ordering ( IndexType  n_row,
IndexType  n_col,
IndexType  Alen,
Colamd_Row< IndexType >  Row[],
colamd_col< IndexType >  Col[],
IndexType  A[],
IndexType  head[],
IndexType  n_col2,
IndexType  max_deg,
IndexType  pfree 
)
static

Definition at line 937 of file Ordering.h.

◆ first_aligned() [1/2]

template<int Alignment, typename Scalar , typename Index >
EIGEN_DEVICE_FUNC Index Eigen::internal::first_aligned ( const Scalar *  array,
Index  size 
)
inline

Definition at line 439 of file Memory.h.

◆ first_aligned() [2/2]

template<int Alignment, typename Derived >
static Index Eigen::internal::first_aligned ( const DenseBase< Derived > &  m)
inlinestatic

Definition at line 639 of file DenseCoeffsBase.h.

◆ first_default_aligned() [1/2]

template<typename Scalar , typename Index >
EIGEN_DEVICE_FUNC Index Eigen::internal::first_default_aligned ( const Scalar *  array,
Index  size 
)
inline

Definition at line 467 of file Memory.h.

◆ first_default_aligned() [2/2]

template<typename Derived >
static Index Eigen::internal::first_default_aligned ( const DenseBase< Derived > &  m)
inlinestatic

Definition at line 646 of file DenseCoeffsBase.h.

◆ first_multiple()

template<typename Index >
Index Eigen::internal::first_multiple ( Index  size,
Index  base 
)
inline

Definition at line 476 of file Memory.h.

◆ fortran_to_c_numbering()

template<typename MatrixType >
void Eigen::internal::fortran_to_c_numbering ( MatrixType &  mat)

Definition at line 111 of file PaStiXSupport.h.

◆ garbage_collection()

template<typename IndexType >
static IndexType Eigen::internal::garbage_collection ( IndexType  n_row,
IndexType  n_col,
Colamd_Row< IndexType >  Row[],
colamd_col< IndexType >  Col[],
IndexType  A[],
IndexType *  pfree 
)
static

Definition at line 1700 of file Ordering.h.

◆ gebp_madd()

template<typename CJ , typename A , typename B , typename C , typename T >
EIGEN_STRONG_INLINE void Eigen::internal::gebp_madd ( const CJ &  cj,
A &  a,
B &  b,
C &  c,
T &  t 
)

Definition at line 331 of file GeneralBlockPanelKernel.h.

◆ general_det3_helper()

template<typename Derived >
EIGEN_DEVICE_FUNC const Derived::Scalar Eigen::internal::general_det3_helper ( const MatrixBase< Derived > &  matrix,
int  i1,
int  i2,
int  i3,
int  j1,
int  j2,
int  j3 
)
inline

Definition at line 205 of file InverseImpl.h.

◆ generic_fast_tanh_float()

template<typename T >
T Eigen::internal::generic_fast_tanh_float ( const T &  a_x)

Definition at line 26 of file MathFunctionsImpl.h.

◆ handmade_aligned_free()

void Eigen::internal::handmade_aligned_free ( void *  ptr)
inline

Definition at line 96 of file Memory.h.

◆ handmade_aligned_malloc()

void* Eigen::internal::handmade_aligned_malloc ( std::size_t  size)
inline

Definition at line 86 of file Memory.h.

◆ handmade_aligned_realloc()

void* Eigen::internal::handmade_aligned_realloc ( void *  ptr,
std::size_t  size,
std::size_t  = 0 
)
inline

Definition at line 106 of file Memory.h.

◆ householder_qr_inplace_unblocked()

template<typename MatrixQR , typename HCoeffs >
void Eigen::internal::householder_qr_inplace_unblocked ( MatrixQR &  mat,
HCoeffs &  hCoeffs,
typename MatrixQR::Scalar *  tempData = 0 
)

Definition at line 256 of file HouseholderQR.h.

◆ ignore_unused_variable()

template<typename T >
EIGEN_DEVICE_FUNC void Eigen::internal::ignore_unused_variable ( const T &  )

Definition at line 612 of file Macros.h.

◆ init_rows_cols()

template<typename IndexType >
static IndexType Eigen::internal::init_rows_cols ( IndexType  n_row,
IndexType  n_col,
Colamd_Row< IndexType >  Row[],
colamd_col< IndexType >  col[],
IndexType  A[],
IndexType  p[],
IndexType  stats[COLAMD_STATS] 
)
static

Definition at line 484 of file Ordering.h.

◆ init_scoring()

template<typename IndexType >
static void Eigen::internal::init_scoring ( IndexType  n_row,
IndexType  n_col,
Colamd_Row< IndexType >  Row[],
colamd_col< IndexType >  Col[],
IndexType  A[],
IndexType  head[],
double  knobs[COLAMD_KNOBS],
IndexType *  p_n_row2,
IndexType *  p_n_col2,
IndexType *  p_max_deg 
)
static

Definition at line 700 of file Ordering.h.

◆ is_same_dense() [1/2]

template<typename T1 , typename T2 >
bool Eigen::internal::is_same_dense ( const T1 &  mat1,
const T2 &  mat2,
typename enable_if< has_direct_access< T1 >::ret &&has_direct_access< T2 >::ret, T1 >::type *  = 0 
)

Definition at line 652 of file XprHelper.h.

◆ is_same_dense() [2/2]

template<typename T1 , typename T2 >
bool Eigen::internal::is_same_dense ( const T1 &  ,
const T2 &  ,
typename enable_if<!(has_direct_access< T1 >::ret &&has_direct_access< T2 >::ret), T1 >::type *  = 0 
)

Definition at line 658 of file XprHelper.h.

◆ least_square_conjugate_gradient()

template<typename MatrixType , typename Rhs , typename Dest , typename Preconditioner >
EIGEN_DONT_INLINE void Eigen::internal::least_square_conjugate_gradient ( const MatrixType &  mat,
const Rhs &  rhs,
Dest &  x,
const Preconditioner &  precond,
Index iters,
typename Dest::RealScalar &  tol_error 
)

Definition at line 28 of file LeastSquareConjugateGradient.h.

◆ llt_rank_update_lower()

template<typename MatrixType , typename VectorType >
static Index Eigen::internal::llt_rank_update_lower ( MatrixType &  mat,
const VectorType &  vec,
const typename MatrixType::RealScalar &  sigma 
)
static

Definition at line 229 of file LLT.h.

◆ LUnumTempV()

Index Eigen::internal::LUnumTempV ( Index m,
Index w,
Index t,
Index b 
)
inline

Definition at line 39 of file SparseLU_Memory.h.

◆ LUTempSpace()

template<typename Scalar >
Index Eigen::internal::LUTempSpace ( Index m,
Index w 
)
inline

Definition at line 45 of file SparseLU_Memory.h.

◆ make_block_householder_triangular_factor()

template<typename TriangularFactorType , typename VectorsType , typename CoeffsType >
void Eigen::internal::make_block_householder_triangular_factor ( TriangularFactorType &  triFactor,
const VectorsType &  vectors,
const CoeffsType &  hCoeffs 
)

Definition at line 51 of file BlockHouseholder.h.

◆ manage_caching_sizes()

void Eigen::internal::manage_caching_sizes ( Action  action,
std::ptrdiff_t *  l1,
std::ptrdiff_t *  l2,
std::ptrdiff_t *  l3 
)
inline

Definition at line 55 of file GeneralBlockPanelKernel.h.

◆ manage_caching_sizes_helper()

std::ptrdiff_t Eigen::internal::manage_caching_sizes_helper ( std::ptrdiff_t  a,
std::ptrdiff_t  b 
)
inline

Definition at line 23 of file GeneralBlockPanelKernel.h.

◆ manage_multi_threading()

void Eigen::internal::manage_multi_threading ( Action  action,
int *  v 
)
inline

Definition at line 18 of file Parallelizer.h.

◆ map_superlu()

template<typename Scalar , int Flags, typename Index >
MappedSparseMatrix<Scalar,Flags,Index> Eigen::internal::map_superlu ( SluMatrix sluMat)

View a Super LU matrix as an Eigen expression

Definition at line 298 of file SuperLUSupport.h.

◆ minimum_degree_ordering()

template<typename Scalar , typename StorageIndex >
void Eigen::internal::minimum_degree_ordering ( SparseMatrix< Scalar, ColMajor, StorageIndex > &  C,
PermutationMatrix< Dynamic, Dynamic, StorageIndex > &  perm 
)

Definition at line 94 of file Amd.h.

◆ nr_etdfs()

template<typename IndexVector >
void Eigen::internal::nr_etdfs ( typename IndexVector::Scalar  n,
IndexVector &  parent,
IndexVector &  first_kid,
IndexVector &  next_kid,
IndexVector &  post,
typename IndexVector::Scalar  postnum 
)

Depth-first search from vertex n. No recursion. This routine was contributed by Cédric Doucet, CEDRAT Group, Meylan, France.

Definition at line 130 of file SparseColEtree.h.

◆ operator<<() [1/7]

std::ostream& Eigen::internal::operator<< ( std::ostream &  s,
const Packet16uc v 
)
inline

Definition at line 193 of file AltiVec/PacketMath.h.

◆ operator<<() [2/7]

std::ostream& Eigen::internal::operator<< ( std::ostream &  s,
const Packet4f v 
)
inline

Definition at line 205 of file AltiVec/PacketMath.h.

◆ operator<<() [3/7]

std::ostream & Eigen::internal::operator<< ( std::ostream &  s,
const Packet4i v 
)
inline

Definition at line 216 of file AltiVec/PacketMath.h.

◆ operator<<() [4/7]

std::ostream & Eigen::internal::operator<< ( std::ostream &  s,
const Packet4ui v 
)
inline

Definition at line 227 of file AltiVec/PacketMath.h.

◆ operator<<() [5/7]

std::ostream& Eigen::internal::operator<< ( std::ostream &  s,
const Packet2l v 
)
inline

Definition at line 237 of file ZVector/PacketMath.h.

◆ operator<<() [6/7]

std::ostream& Eigen::internal::operator<< ( std::ostream &  s,
const Packet2ul v 
)
inline

Definition at line 245 of file ZVector/PacketMath.h.

◆ operator<<() [7/7]

std::ostream& Eigen::internal::operator<< ( std::ostream &  s,
const Packet2d v 
)
inline

Definition at line 253 of file ZVector/PacketMath.h.

◆ order_children()

template<typename IndexType >
static void Eigen::internal::order_children ( IndexType  n_col,
colamd_col< IndexType >  Col[],
IndexType  p[] 
)
inlinestatic

Definition at line 1448 of file Ordering.h.

◆ ordering_helper_at_plus_a()

template<typename MatrixType >
void Eigen::internal::ordering_helper_at_plus_a ( const MatrixType &  A,
MatrixType &  symmat 
)

Definition at line 27 of file Ordering.h.

◆ outer_product_selector_run() [1/2]

template<typename Dst , typename Lhs , typename Rhs , typename Func >
void Eigen::internal::outer_product_selector_run ( Dst &  dst,
const Lhs &  lhs,
const Rhs &  rhs,
const Func &  func,
const false_type  
)

Definition at line 272 of file ProductEvaluators.h.

◆ outer_product_selector_run() [2/2]

template<typename Dst , typename Lhs , typename Rhs , typename Func >
void Eigen::internal::outer_product_selector_run ( Dst &  dst,
const Lhs &  lhs,
const Rhs &  rhs,
const Func &  func,
const true_type  
)

Definition at line 285 of file ProductEvaluators.h.

◆ p2ui_CONJ_XOR()

uint32x2_t Eigen::internal::p2ui_CONJ_XOR ( )
inline

Definition at line 29 of file NEON/Complex.h.

◆ p4ui_CONJ_XOR()

uint32x4_t Eigen::internal::p4ui_CONJ_XOR ( )
inline

Definition at line 18 of file NEON/Complex.h.

◆ pabs() [1/8]

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::pabs ( const Packet a)
inline

Definition at line 190 of file GenericPacketMath.h.

◆ pabs() [2/8]

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::pabs ( const Packet8f a)

Definition at line 342 of file AVX/PacketMath.h.

◆ pabs() [3/8]

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::pabs ( const Packet4d a)

Definition at line 347 of file AVX/PacketMath.h.

◆ pabs() [4/8]

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::pabs ( const Packet2d a)

Definition at line 447 of file SSE/PacketMath.h.

◆ pabs() [5/8]

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::pabs ( const Packet4f a)

Definition at line 530 of file AltiVec/PacketMath.h.

◆ pabs() [6/8]

template<>
EIGEN_STRONG_INLINE Packet4i Eigen::internal::pabs ( const Packet4i a)

Definition at line 531 of file AltiVec/PacketMath.h.

◆ pabs() [7/8]

template<>
EIGEN_STRONG_INLINE Packet16f Eigen::internal::pabs ( const Packet16f a)

Definition at line 648 of file AVX512/PacketMath.h.

◆ pabs() [8/8]

template<>
EIGEN_STRONG_INLINE Packet8d Eigen::internal::pabs ( const Packet8d a)

Definition at line 654 of file AVX512/PacketMath.h.

◆ pabs< Packet2d >()

Definition at line 707 of file ZVector/PacketMath.h.

◆ pabs< Packet4f >()

Definition at line 708 of file ZVector/PacketMath.h.

◆ pabs< Packet4i >()

Definition at line 706 of file ZVector/PacketMath.h.

◆ pacos()

template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet Eigen::internal::pacos ( const Packet a)

Definition at line 382 of file GenericPacketMath.h.

◆ padd() [1/2]

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::padd ( const Packet a,
const Packet b 
)
inline

Definition at line 151 of file GenericPacketMath.h.

◆ padd() [2/2]

template<typename Packet >
DoublePacket<Packet> Eigen::internal::padd ( const DoublePacket< Packet > &  a,
const DoublePacket< Packet > &  b 
)

Definition at line 574 of file GeneralBlockPanelKernel.h.

◆ padd< Packet16f >()

template<>
EIGEN_STRONG_INLINE Packet16f Eigen::internal::padd< Packet16f > ( const Packet16f a,
const Packet16f b 
)

Definition at line 152 of file AVX512/PacketMath.h.

◆ padd< Packet1cd >()

template<>
EIGEN_STRONG_INLINE Packet1cd Eigen::internal::padd< Packet1cd > ( const Packet1cd a,
const Packet1cd b 
)

Definition at line 301 of file SSE/Complex.h.

◆ padd< Packet2cd >()

template<>
EIGEN_STRONG_INLINE Packet2cd Eigen::internal::padd< Packet2cd > ( const Packet2cd a,
const Packet2cd b 
)

Definition at line 272 of file AVX/Complex.h.

◆ padd< Packet2cf >()

template<>
EIGEN_STRONG_INLINE Packet2cf Eigen::internal::padd< Packet2cf > ( const Packet2cf a,
const Packet2cf b 
)

Definition at line 98 of file AltiVec/Complex.h.

◆ padd< Packet2d >()

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::padd< Packet2d > ( const Packet2d a,
const Packet2d b 
)

Definition at line 199 of file SSE/PacketMath.h.

◆ padd< Packet4cf >()

template<>
EIGEN_STRONG_INLINE Packet4cf Eigen::internal::padd< Packet4cf > ( const Packet4cf a,
const Packet4cf b 
)

Definition at line 50 of file AVX/Complex.h.

◆ padd< Packet4d >()

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::padd< Packet4d > ( const Packet4d a,
const Packet4d b 
)

Definition at line 131 of file AVX/PacketMath.h.

◆ padd< Packet4f >()

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::padd< Packet4f > ( const Packet4f a,
const Packet4f b 
)

Definition at line 349 of file AltiVec/PacketMath.h.

◆ padd< Packet4i >()

template<>
EIGEN_STRONG_INLINE Packet4i Eigen::internal::padd< Packet4i > ( const Packet4i a,
const Packet4i b 
)

Definition at line 350 of file AltiVec/PacketMath.h.

◆ padd< Packet8d >()

template<>
EIGEN_STRONG_INLINE Packet8d Eigen::internal::padd< Packet8d > ( const Packet8d a,
const Packet8d b 
)

Definition at line 157 of file AVX512/PacketMath.h.

◆ padd< Packet8f >()

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::padd< Packet8f > ( const Packet8f a,
const Packet8f b 
)

Definition at line 130 of file AVX/PacketMath.h.

◆ palign()

template<int Offset, typename PacketType >
void Eigen::internal::palign ( PacketType &  first,
const PacketType &  second 
)
inline

Definition at line 514 of file GenericPacketMath.h.

◆ pand()

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::pand ( const Packet a,
const Packet b 
)
inline

Definition at line 198 of file GenericPacketMath.h.

◆ pand< Packet16f >()

template<>
EIGEN_STRONG_INLINE Packet16f Eigen::internal::pand< Packet16f > ( const Packet16f a,
const Packet16f b 
)

Definition at line 253 of file AVX512/PacketMath.h.

◆ pand< Packet1cd >()

template<>
EIGEN_STRONG_INLINE Packet1cd Eigen::internal::pand< Packet1cd > ( const Packet1cd a,
const Packet1cd b 
)

Definition at line 324 of file SSE/Complex.h.

◆ pand< Packet2cd >()

template<>
EIGEN_STRONG_INLINE Packet2cd Eigen::internal::pand< Packet2cd > ( const Packet2cd a,
const Packet2cd b 
)

Definition at line 291 of file AVX/Complex.h.

◆ pand< Packet2cf >()

template<>
EIGEN_STRONG_INLINE Packet2cf Eigen::internal::pand< Packet2cf > ( const Packet2cf a,
const Packet2cf b 
)

Definition at line 122 of file AltiVec/Complex.h.

◆ pand< Packet2d >()

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::pand< Packet2d > ( const Packet2d a,
const Packet2d b 
)

Definition at line 291 of file SSE/PacketMath.h.

◆ pand< Packet4cf >()

template<>
EIGEN_STRONG_INLINE Packet4cf Eigen::internal::pand< Packet4cf > ( const Packet4cf a,
const Packet4cf b 
)

Definition at line 70 of file AVX/Complex.h.

◆ pand< Packet4d >()

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::pand< Packet4d > ( const Packet4d a,
const Packet4d b 
)

Definition at line 202 of file AVX/PacketMath.h.

◆ pand< Packet4f >()

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::pand< Packet4f > ( const Packet4f a,
const Packet4f b 
)

Definition at line 397 of file AltiVec/PacketMath.h.

◆ pand< Packet4i >()

template<>
EIGEN_STRONG_INLINE Packet4i Eigen::internal::pand< Packet4i > ( const Packet4i a,
const Packet4i b 
)

Definition at line 398 of file AltiVec/PacketMath.h.

◆ pand< Packet8d >()

template<>
EIGEN_STRONG_INLINE Packet8d Eigen::internal::pand< Packet8d > ( const Packet8d a,
const Packet8d b 
)

Definition at line 279 of file AVX512/PacketMath.h.

◆ pand< Packet8f >()

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::pand< Packet8f > ( const Packet8f a,
const Packet8f b 
)

Definition at line 201 of file AVX/PacketMath.h.

◆ pandnot()

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::pandnot ( const Packet a,
const Packet b 
)
inline

Definition at line 210 of file GenericPacketMath.h.

◆ pandnot< Packet16f >()

Definition at line 388 of file AVX512/PacketMath.h.

◆ pandnot< Packet1cd >()

Definition at line 327 of file SSE/Complex.h.

◆ pandnot< Packet2cd >()

Definition at line 294 of file AVX/Complex.h.

◆ pandnot< Packet2cf >()

Definition at line 125 of file AltiVec/Complex.h.

◆ pandnot< Packet2d >()

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::pandnot< Packet2d > ( const Packet2d a,
const Packet2d b 
)

Definition at line 303 of file SSE/PacketMath.h.

◆ pandnot< Packet4cf >()

Definition at line 73 of file AVX/Complex.h.

◆ pandnot< Packet4d >()

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::pandnot< Packet4d > ( const Packet4d a,
const Packet4d b 
)

Definition at line 211 of file AVX/PacketMath.h.

◆ pandnot< Packet4f >()

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::pandnot< Packet4f > ( const Packet4f a,
const Packet4f b 
)

Definition at line 406 of file AltiVec/PacketMath.h.

◆ pandnot< Packet4i >()

template<>
EIGEN_STRONG_INLINE Packet4i Eigen::internal::pandnot< Packet4i > ( const Packet4i a,
const Packet4i b 
)

Definition at line 407 of file AltiVec/PacketMath.h.

◆ pandnot< Packet8d >()

template<>
EIGEN_STRONG_INLINE Packet8d Eigen::internal::pandnot< Packet8d > ( const Packet8d a,
const Packet8d b 
)

Definition at line 414 of file AVX512/PacketMath.h.

◆ pandnot< Packet8f >()

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::pandnot< Packet8f > ( const Packet8f a,
const Packet8f b 
)

Definition at line 210 of file AVX/PacketMath.h.

◆ parallelize_gemm()

template<bool Condition, typename Functor , typename Index >
void Eigen::internal::parallelize_gemm ( const Functor &  func,
Index  rows,
Index  cols,
Index  depth,
bool  transpose 
)

Definition at line 86 of file Parallelizer.h.

◆ parg()

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::parg ( const Packet a)
inline

Definition at line 194 of file GenericPacketMath.h.

◆ partial_lu_inplace()

template<typename MatrixType , typename TranspositionType >
void Eigen::internal::partial_lu_inplace ( MatrixType &  lu,
TranspositionType &  row_transpositions,
typename TranspositionType::StorageIndex &  nb_transpositions 
)

Definition at line 502 of file PartialPivLU.h.

◆ pasin()

template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet Eigen::internal::pasin ( const Packet a)

Definition at line 378 of file GenericPacketMath.h.

◆ patan()

template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet Eigen::internal::patan ( const Packet a)

Definition at line 386 of file GenericPacketMath.h.

◆ pblend() [1/9]

template<>
EIGEN_STRONG_INLINE Packet2cf Eigen::internal::pblend ( const Selector< 2 > &  ifPacket,
const Packet2cf thenPacket,
const Packet2cf elsePacket 
)

Definition at line 474 of file SSE/Complex.h.

◆ pblend() [2/9]

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::pblend ( const Selector< unpacket_traits< Packet >::size > &  ifPacket,
const Packet thenPacket,
const Packet elsePacket 
)
inline

Definition at line 557 of file GenericPacketMath.h.

◆ pblend() [3/9]

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::pblend ( const Selector< 8 > &  ifPacket,
const Packet8f thenPacket,
const Packet8f elsePacket 
)

Definition at line 599 of file AVX/PacketMath.h.

◆ pblend() [4/9]

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::pblend ( const Selector< 4 > &  ifPacket,
const Packet4d thenPacket,
const Packet4d elsePacket 
)

Definition at line 605 of file AVX/PacketMath.h.

◆ pblend() [5/9]

template<>
EIGEN_STRONG_INLINE Packet4i Eigen::internal::pblend ( const Selector< 4 > &  ifPacket,
const Packet4i thenPacket,
const Packet4i elsePacket 
)

Definition at line 741 of file AltiVec/PacketMath.h.

◆ pblend() [6/9]

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::pblend ( const Selector< 4 > &  ifPacket,
const Packet4f thenPacket,
const Packet4f elsePacket 
)

Definition at line 747 of file AltiVec/PacketMath.h.

◆ pblend() [7/9]

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::pblend ( const Selector< 2 > &  ifPacket,
const Packet2d thenPacket,
const Packet2d elsePacket 
)

Definition at line 810 of file SSE/PacketMath.h.

◆ pblend() [8/9]

template<>
EIGEN_STRONG_INLINE Packet16f Eigen::internal::pblend ( const Selector< 16 > &  ,
const Packet16f ,
const Packet16f  
)

Definition at line 1298 of file AVX512/PacketMath.h.

◆ pblend() [9/9]

template<>
EIGEN_STRONG_INLINE Packet8d Eigen::internal::pblend ( const Selector< 8 > &  ,
const Packet8d ,
const Packet8d  
)

Definition at line 1305 of file AVX512/PacketMath.h.

◆ pbroadcast2()

template<typename Packet >
EIGEN_DEVICE_FUNC void Eigen::internal::pbroadcast2 ( const typename unpacket_traits< Packet >::type *  a,
Packet a0,
Packet a1 
)
inline

Definition at line 273 of file GenericPacketMath.h.

◆ pbroadcast4()

template<typename Packet >
EIGEN_DEVICE_FUNC void Eigen::internal::pbroadcast4 ( const typename unpacket_traits< Packet >::type *  a,
Packet a0,
Packet a1,
Packet a2,
Packet a3 
)
inline

Definition at line 256 of file GenericPacketMath.h.

◆ pbroadcast4< Packet2d >()

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pbroadcast4< Packet2d > ( const double *  a,
Packet2d a0,
Packet2d a1,
Packet2d a2,
Packet2d a3 
)

Definition at line 475 of file SSE/PacketMath.h.

◆ pbroadcast4< Packet4f >()

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pbroadcast4< Packet4f > ( const float *  a,
Packet4f a0,
Packet4f a1,
Packet4f a2,
Packet4f a3 
)

Definition at line 289 of file AltiVec/PacketMath.h.

◆ pbroadcast4< Packet4i >()

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pbroadcast4< Packet4i > ( const int *  a,
Packet4i a0,
Packet4i a1,
Packet4i a2,
Packet4i a3 
)

Definition at line 299 of file AltiVec/PacketMath.h.

◆ pcast() [1/3]

template<typename SrcPacket , typename TgtPacket >
EIGEN_DEVICE_FUNC TgtPacket Eigen::internal::pcast ( const SrcPacket &  a)
inline

Definition at line 134 of file GenericPacketMath.h.

◆ pcast() [2/3]

template<typename SrcPacket , typename TgtPacket >
EIGEN_DEVICE_FUNC TgtPacket Eigen::internal::pcast ( const SrcPacket &  a,
const SrcPacket &   
)
inline

Definition at line 139 of file GenericPacketMath.h.

◆ pcast() [3/3]

template<typename SrcPacket , typename TgtPacket >
EIGEN_DEVICE_FUNC TgtPacket Eigen::internal::pcast ( const SrcPacket &  a,
const SrcPacket &  ,
const SrcPacket &  ,
const SrcPacket &   
)
inline

Definition at line 145 of file GenericPacketMath.h.

◆ pcast< Packet2d, Packet4f >()

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::pcast< Packet2d, Packet4f > ( const Packet2d a,
const Packet2d b 
)

Definition at line 54 of file SSE/TypeCasting.h.

◆ pcast< Packet4f, Packet2d >()

Definition at line 67 of file SSE/TypeCasting.h.

◆ pcast< Packet4f, Packet4i >()

Definition at line 26 of file SSE/TypeCasting.h.

◆ pcast< Packet4i, Packet4f >()

Definition at line 40 of file SSE/TypeCasting.h.

◆ pcast< Packet8f, Packet8i >()

Definition at line 39 of file AVX/TypeCasting.h.

◆ pcast< Packet8i, Packet8f >()

Definition at line 43 of file AVX/TypeCasting.h.

◆ pceil()

template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet Eigen::internal::pceil ( const Packet a)

Definition at line 436 of file GenericPacketMath.h.

◆ pceil< Packet2d >()

Definition at line 641 of file ZVector/PacketMath.h.

◆ pceil< Packet4d >()

Definition at line 196 of file AVX/PacketMath.h.

◆ pceil< Packet4f >()

Definition at line 410 of file AltiVec/PacketMath.h.

◆ pceil< Packet8f >()

Definition at line 195 of file AVX/PacketMath.h.

◆ pconj() [1/14]

template<>
EIGEN_STRONG_INLINE Packet4cf Eigen::internal::pconj ( const Packet4cf a)

Definition at line 56 of file AVX/Complex.h.

◆ pconj() [2/14]

template<>
EIGEN_STRONG_INLINE Packet2cf Eigen::internal::pconj ( const Packet2cf a)

Definition at line 101 of file AltiVec/Complex.h.

◆ pconj() [3/14]

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::pconj ( const Packet8f a)

Definition at line 145 of file AVX/PacketMath.h.

◆ pconj() [4/14]

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::pconj ( const Packet4d a)

Definition at line 146 of file AVX/PacketMath.h.

◆ pconj() [5/14]

template<>
EIGEN_STRONG_INLINE Packet8i Eigen::internal::pconj ( const Packet8i a)

Definition at line 147 of file AVX/PacketMath.h.

◆ pconj() [6/14]

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::pconj ( const Packet a)
inline

Definition at line 166 of file GenericPacketMath.h.

◆ pconj() [7/14]

template<>
EIGEN_STRONG_INLINE Packet16f Eigen::internal::pconj ( const Packet16f a)

Definition at line 183 of file AVX512/PacketMath.h.

◆ pconj() [8/14]

template<>
EIGEN_STRONG_INLINE Packet8d Eigen::internal::pconj ( const Packet8d a)

Definition at line 187 of file AVX512/PacketMath.h.

◆ pconj() [9/14]

template<>
EIGEN_STRONG_INLINE Packet16i Eigen::internal::pconj ( const Packet16i a)

Definition at line 191 of file AVX512/PacketMath.h.

◆ pconj() [10/14]

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::pconj ( const Packet2d a)

Definition at line 222 of file SSE/PacketMath.h.

◆ pconj() [11/14]

template<>
EIGEN_STRONG_INLINE Packet2cd Eigen::internal::pconj ( const Packet2cd a)

Definition at line 275 of file AVX/Complex.h.

◆ pconj() [12/14]

template<>
EIGEN_STRONG_INLINE Packet1cd Eigen::internal::pconj ( const Packet1cd a)

Definition at line 304 of file SSE/Complex.h.

◆ pconj() [13/14]

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::pconj ( const Packet4f a)

Definition at line 358 of file AltiVec/PacketMath.h.

◆ pconj() [14/14]

template<>
EIGEN_STRONG_INLINE Packet4i Eigen::internal::pconj ( const Packet4i a)

Definition at line 359 of file AltiVec/PacketMath.h.

◆ pcos()

template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet Eigen::internal::pcos ( const Packet a)

Definition at line 370 of file GenericPacketMath.h.

◆ pcos< Packet4f >()

Definition at line 359 of file arch/SSE/MathFunctions.h.

◆ pcosh()

template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet Eigen::internal::pcosh ( const Packet a)

Definition at line 394 of file GenericPacketMath.h.

◆ pcplxflip() [1/3]

EIGEN_STRONG_INLINE Packet2cf Eigen::internal::pcplxflip ( const Packet2cf x)

Definition at line 258 of file SSE/Complex.h.

◆ pcplxflip() [2/3]

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::pcplxflip ( const Packet a)
inline

Definition at line 352 of file GenericPacketMath.h.

◆ pcplxflip() [3/3]

EIGEN_STRONG_INLINE Packet1cd Eigen::internal::pcplxflip ( const Packet1cd x)

Definition at line 459 of file SSE/Complex.h.

◆ pcplxflip< Packet2cd >()

Definition at line 429 of file AVX/Complex.h.

◆ pcplxflip< Packet2cf >()

Definition at line 253 of file AltiVec/Complex.h.

◆ pcplxflip< Packet4cf >()

Definition at line 234 of file AVX/Complex.h.

◆ pdiv()

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::pdiv ( const Packet a,
const Packet b 
)
inline

Definition at line 175 of file GenericPacketMath.h.

◆ pdiv< Packet16f >()

template<>
EIGEN_STRONG_INLINE Packet16f Eigen::internal::pdiv< Packet16f > ( const Packet16f a,
const Packet16f b 
)

Definition at line 207 of file AVX512/PacketMath.h.

◆ pdiv< Packet1cd >()

template<>
EIGEN_STRONG_INLINE Packet1cd Eigen::internal::pdiv< Packet1cd > ( const Packet1cd a,
const Packet1cd b 
)

Definition at line 451 of file SSE/Complex.h.

◆ pdiv< Packet2cd >()

template<>
EIGEN_STRONG_INLINE Packet2cd Eigen::internal::pdiv< Packet2cd > ( const Packet2cd a,
const Packet2cd b 
)

Definition at line 421 of file AVX/Complex.h.

◆ pdiv< Packet2cf >()

template<>
EIGEN_STRONG_INLINE Packet2cf Eigen::internal::pdiv< Packet2cf > ( const Packet2cf a,
const Packet2cf b 
)

Definition at line 245 of file AltiVec/Complex.h.

◆ pdiv< Packet2d >()

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::pdiv< Packet2d > ( const Packet2d a,
const Packet2d b 
)

Definition at line 244 of file SSE/PacketMath.h.

◆ pdiv< Packet4cf >()

template<>
EIGEN_STRONG_INLINE Packet4cf Eigen::internal::pdiv< Packet4cf > ( const Packet4cf a,
const Packet4cf b 
)

Definition at line 225 of file AVX/Complex.h.

◆ pdiv< Packet4d >()

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::pdiv< Packet4d > ( const Packet4d a,
const Packet4d b 
)

Definition at line 154 of file AVX/PacketMath.h.

◆ pdiv< Packet4f >()

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::pdiv< Packet4f > ( const Packet4f a,
const Packet4f b 
)

Definition at line 364 of file AltiVec/PacketMath.h.

◆ pdiv< Packet4i >()

template<>
EIGEN_STRONG_INLINE Packet4i Eigen::internal::pdiv< Packet4i > ( const Packet4i a,
const Packet4i b 
)

Definition at line 382 of file AltiVec/PacketMath.h.

◆ pdiv< Packet8d >()

template<>
EIGEN_STRONG_INLINE Packet8d Eigen::internal::pdiv< Packet8d > ( const Packet8d a,
const Packet8d b 
)

Definition at line 212 of file AVX512/PacketMath.h.

◆ pdiv< Packet8f >()

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::pdiv< Packet8f > ( const Packet8f a,
const Packet8f b 
)

Definition at line 153 of file AVX/PacketMath.h.

◆ pdiv< Packet8i >()

template<>
EIGEN_STRONG_INLINE Packet8i Eigen::internal::pdiv< Packet8i > ( const Packet8i ,
const Packet8i  
)

Definition at line 155 of file AVX/PacketMath.h.

◆ permute_symm_to_fullsymm()

template<int Mode, typename MatrixType , int DestOrder>
void Eigen::internal::permute_symm_to_fullsymm ( const MatrixType &  mat,
SparseMatrix< typename MatrixType::Scalar, DestOrder, typename MatrixType::StorageIndex > &  _dest,
const typename MatrixType::StorageIndex *  perm = 0 
)

Definition at line 397 of file SparseSelfAdjointView.h.

◆ permute_symm_to_symm() [1/2]

template<int SrcMode, int DstMode, typename MatrixType , int DestOrder>
void Eigen::internal::permute_symm_to_symm ( const MatrixType &  mat,
SparseMatrix< typename MatrixType::Scalar, DestOrder, typename MatrixType::StorageIndex > &  _dest,
const typename MatrixType::StorageIndex *  perm = 0 
)

◆ permute_symm_to_symm() [2/2]

template<int _SrcMode, int _DstMode, typename MatrixType , int DstOrder>
void Eigen::internal::permute_symm_to_symm ( const MatrixType &  mat,
SparseMatrix< typename MatrixType::Scalar, DstOrder, typename MatrixType::StorageIndex > &  _dest,
const typename MatrixType::StorageIndex *  perm 
)

Definition at line 487 of file SparseSelfAdjointView.h.

◆ pexp()

template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet Eigen::internal::pexp ( const Packet a)

Definition at line 402 of file GenericPacketMath.h.

◆ pexp< Packet2d >()

Definition at line 172 of file arch/SSE/MathFunctions.h.

◆ pexp< Packet4d >()

Definition at line 277 of file arch/AVX/MathFunctions.h.

◆ pexp< Packet4f >()

Definition at line 154 of file arch/AltiVec/MathFunctions.h.

◆ pexp< Packet8f >()

Definition at line 209 of file arch/AVX/MathFunctions.h.

◆ pfirst()

template<typename Packet >
EIGEN_DEVICE_FUNC unpacket_traits<Packet>::type Eigen::internal::pfirst ( const Packet a)
inline

Definition at line 315 of file GenericPacketMath.h.

◆ pfirst< Packet16f >()

template<>
EIGEN_STRONG_INLINE float Eigen::internal::pfirst< Packet16f > ( const Packet16f a)

Definition at line 626 of file AVX512/PacketMath.h.

◆ pfirst< Packet16i >()

Definition at line 634 of file AVX512/PacketMath.h.

◆ pfirst< Packet1cd >()

template<>
EIGEN_STRONG_INLINE std::complex< double > Eigen::internal::pfirst< Packet1cd > ( const Packet1cd a)

Definition at line 345 of file SSE/Complex.h.

◆ pfirst< Packet2cd >()

template<>
EIGEN_STRONG_INLINE std::complex<double> Eigen::internal::pfirst< Packet2cd > ( const Packet2cd a)

Definition at line 327 of file AVX/Complex.h.

◆ pfirst< Packet2cf >()

template<>
EIGEN_STRONG_INLINE std::complex< float > Eigen::internal::pfirst< Packet2cf > ( const Packet2cf a)

Definition at line 129 of file AltiVec/Complex.h.

◆ pfirst< Packet2d >()

template<>
EIGEN_STRONG_INLINE double Eigen::internal::pfirst< Packet2d > ( const Packet2d a)

Definition at line 431 of file SSE/PacketMath.h.

◆ pfirst< Packet4cf >()

template<>
EIGEN_STRONG_INLINE std::complex<float> Eigen::internal::pfirst< Packet4cf > ( const Packet4cf a)

Definition at line 119 of file AVX/Complex.h.

◆ pfirst< Packet4d >()

template<>
EIGEN_STRONG_INLINE double Eigen::internal::pfirst< Packet4d > ( const Packet4d a)

Definition at line 319 of file AVX/PacketMath.h.

◆ pfirst< Packet4f >()

template<>
EIGEN_STRONG_INLINE float Eigen::internal::pfirst< Packet4f > ( const Packet4f a)

Definition at line 519 of file AltiVec/PacketMath.h.

◆ pfirst< Packet4i >()

Definition at line 520 of file AltiVec/PacketMath.h.

◆ pfirst< Packet8d >()

template<>
EIGEN_STRONG_INLINE double Eigen::internal::pfirst< Packet8d > ( const Packet8d a)

Definition at line 630 of file AVX512/PacketMath.h.

◆ pfirst< Packet8f >()

template<>
EIGEN_STRONG_INLINE float Eigen::internal::pfirst< Packet8f > ( const Packet8f a)

Definition at line 316 of file AVX/PacketMath.h.

◆ pfirst< Packet8i >()

Definition at line 322 of file AVX/PacketMath.h.

◆ pfloor()

template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet Eigen::internal::pfloor ( const Packet a)

Definition at line 432 of file GenericPacketMath.h.

◆ pfloor< Packet2d >()

Definition at line 649 of file ZVector/PacketMath.h.

◆ pfloor< Packet4d >()

Definition at line 199 of file AVX/PacketMath.h.

◆ pfloor< Packet4f >()

Definition at line 411 of file AltiVec/PacketMath.h.

◆ pfloor< Packet8f >()

Definition at line 198 of file AVX/PacketMath.h.

◆ pgather()

template<typename Scalar , typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::pgather ( const Scalar *  from,
Index   
)
inline

Definition at line 292 of file GenericPacketMath.h.

◆ pgather< double, Packet2d >()

template<>
EIGEN_DEVICE_FUNC Packet2d Eigen::internal::pgather< double, Packet2d > ( const double *  from,
Index  stride 
)
inline

Definition at line 370 of file SSE/PacketMath.h.

◆ pgather< double, Packet4d >()

template<>
EIGEN_DEVICE_FUNC Packet4d Eigen::internal::pgather< double, Packet4d > ( const double *  from,
Index  stride 
)
inline

Definition at line 265 of file AVX/PacketMath.h.

◆ pgather< double, Packet8d >()

template<>
EIGEN_DEVICE_FUNC Packet8d Eigen::internal::pgather< double, Packet8d > ( const double *  from,
Index  stride 
)
inline

Definition at line 576 of file AVX512/PacketMath.h.

◆ pgather< float, Packet16f >()

template<>
EIGEN_DEVICE_FUNC Packet16f Eigen::internal::pgather< float, Packet16f > ( const float *  from,
Index  stride 
)
inline

Definition at line 566 of file AVX512/PacketMath.h.

◆ pgather< float, Packet4f >()

template<>
EIGEN_DEVICE_FUNC Packet4f Eigen::internal::pgather< float, Packet4f > ( const float *  from,
Index  stride 
)
inline

Definition at line 309 of file AltiVec/PacketMath.h.

◆ pgather< float, Packet8f >()

template<>
EIGEN_DEVICE_FUNC Packet8f Eigen::internal::pgather< float, Packet8f > ( const float *  from,
Index  stride 
)
inline

Definition at line 260 of file AVX/PacketMath.h.

◆ pgather< int, Packet4i >()

template<>
EIGEN_DEVICE_FUNC Packet4i Eigen::internal::pgather< int, Packet4i > ( const int *  from,
Index  stride 
)
inline

Definition at line 318 of file AltiVec/PacketMath.h.

◆ pgather< std::complex< double >, Packet1cd >()

template<>
EIGEN_DEVICE_FUNC Packet1cd Eigen::internal::pgather< std::complex< double >, Packet1cd > ( const std::complex< double > *  from,
Index stride  EIGEN_UNUSED 
)
inline

Definition at line 118 of file ZVector/Complex.h.

◆ pgather< std::complex< double >, Packet2cd >()

template<>
EIGEN_DEVICE_FUNC Packet2cd Eigen::internal::pgather< std::complex< double >, Packet2cd > ( const std::complex< double > *  from,
Index  stride 
)
inline

Definition at line 313 of file AVX/Complex.h.

◆ pgather< std::complex< float >, Packet2cf >()

template<>
EIGEN_DEVICE_FUNC Packet2cf Eigen::internal::pgather< std::complex< float >, Packet2cf > ( const std::complex< float > *  from,
Index  stride 
)
inline

Definition at line 83 of file AltiVec/Complex.h.

◆ pgather< std::complex< float >, Packet4cf >()

template<>
EIGEN_DEVICE_FUNC Packet4cf Eigen::internal::pgather< std::complex< float >, Packet4cf > ( const std::complex< float > *  from,
Index  stride 
)
inline

Definition at line 95 of file AVX/Complex.h.

◆ pinsertfirst() [1/9]

template<>
EIGEN_STRONG_INLINE Packet4cf Eigen::internal::pinsertfirst ( const Packet4cf a,
std::complex< float >  b 
)

Definition at line 459 of file AVX/Complex.h.

◆ pinsertfirst() [2/9]

template<>
EIGEN_STRONG_INLINE Packet2cd Eigen::internal::pinsertfirst ( const Packet2cd a,
std::complex< double >  b 
)

Definition at line 464 of file AVX/Complex.h.

◆ pinsertfirst() [3/9]

template<>
EIGEN_STRONG_INLINE Packet2cf Eigen::internal::pinsertfirst ( const Packet2cf a,
std::complex< float >  b 
)

Definition at line 479 of file SSE/Complex.h.

◆ pinsertfirst() [4/9]

template<>
EIGEN_STRONG_INLINE Packet1cd Eigen::internal::pinsertfirst ( const Packet1cd ,
std::complex< double >  b 
)

Definition at line 484 of file SSE/Complex.h.

◆ pinsertfirst() [5/9]

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::pinsertfirst ( const Packet a,
typename unpacket_traits< Packet >::type  b 
)
inline

Definition at line 563 of file GenericPacketMath.h.

◆ pinsertfirst() [6/9]

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::pinsertfirst ( const Packet8f a,
float  b 
)

Definition at line 612 of file AVX/PacketMath.h.

◆ pinsertfirst() [7/9]

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::pinsertfirst ( const Packet4d a,
double  b 
)

Definition at line 617 of file AVX/PacketMath.h.

◆ pinsertfirst() [8/9]

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::pinsertfirst ( const Packet4f a,
float  b 
)

Definition at line 821 of file SSE/PacketMath.h.

◆ pinsertfirst() [9/9]

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::pinsertfirst ( const Packet2d a,
double  b 
)

Definition at line 830 of file SSE/PacketMath.h.

◆ pinsertlast() [1/9]

template<>
EIGEN_STRONG_INLINE Packet4cf Eigen::internal::pinsertlast ( const Packet4cf a,
std::complex< float >  b 
)

Definition at line 469 of file AVX/Complex.h.

◆ pinsertlast() [2/9]

template<>
EIGEN_STRONG_INLINE Packet2cd Eigen::internal::pinsertlast ( const Packet2cd a,
std::complex< double >  b 
)

Definition at line 474 of file AVX/Complex.h.

◆ pinsertlast() [3/9]

template<>
EIGEN_STRONG_INLINE Packet2cf Eigen::internal::pinsertlast ( const Packet2cf a,
std::complex< float >  b 
)

Definition at line 489 of file SSE/Complex.h.

◆ pinsertlast() [4/9]

template<>
EIGEN_STRONG_INLINE Packet1cd Eigen::internal::pinsertlast ( const Packet1cd ,
std::complex< double >  b 
)

Definition at line 494 of file SSE/Complex.h.

◆ pinsertlast() [5/9]

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::pinsertlast ( const Packet a,
typename unpacket_traits< Packet >::type  b 
)
inline

Definition at line 577 of file GenericPacketMath.h.

◆ pinsertlast() [6/9]

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::pinsertlast ( const Packet8f a,
float  b 
)

Definition at line 622 of file AVX/PacketMath.h.

◆ pinsertlast() [7/9]

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::pinsertlast ( const Packet4d a,
double  b 
)

Definition at line 627 of file AVX/PacketMath.h.

◆ pinsertlast() [8/9]

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::pinsertlast ( const Packet4f a,
float  b 
)

Definition at line 839 of file SSE/PacketMath.h.

◆ pinsertlast() [9/9]

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::pinsertlast ( const Packet2d a,
double  b 
)

Definition at line 849 of file SSE/PacketMath.h.

◆ pload()

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::pload ( const typename unpacket_traits< Packet >::type *  from)
inline

Definition at line 214 of file GenericPacketMath.h.

◆ pload1()

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::pload1 ( const typename unpacket_traits< Packet >::type *  a)
inline

Definition at line 226 of file GenericPacketMath.h.

◆ pload1< Packet16f >()

template<>
EIGEN_STRONG_INLINE Packet16f Eigen::internal::pload1< Packet16f > ( const float *  from)

Definition at line 130 of file AVX512/PacketMath.h.

◆ pload1< Packet4d >()

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::pload1< Packet4d > ( const double *  from)

Definition at line 125 of file AVX/PacketMath.h.

◆ pload1< Packet8d >()

template<>
EIGEN_STRONG_INLINE Packet8d Eigen::internal::pload1< Packet8d > ( const double *  from)

Definition at line 134 of file AVX512/PacketMath.h.

◆ pload1< Packet8f >()

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::pload1< Packet8f > ( const float *  from)

Definition at line 124 of file AVX/PacketMath.h.

◆ pload< Packet16f >()

template<>
EIGEN_STRONG_INLINE Packet16f Eigen::internal::pload< Packet16f > ( const float *  from)

Definition at line 433 of file AVX512/PacketMath.h.

◆ pload< Packet16i >()

template<>
EIGEN_STRONG_INLINE Packet16i Eigen::internal::pload< Packet16i > ( const int *  from)

Definition at line 441 of file AVX512/PacketMath.h.

◆ pload< Packet1cd >()

template<>
EIGEN_STRONG_INLINE Packet1cd Eigen::internal::pload< Packet1cd > ( const std::complex< double > *  from)

Definition at line 330 of file SSE/Complex.h.

◆ pload< Packet2cd >()

template<>
EIGEN_STRONG_INLINE Packet2cd Eigen::internal::pload< Packet2cd > ( const std::complex< double > *  from)

Definition at line 296 of file AVX/Complex.h.

◆ pload< Packet2cf >()

template<>
EIGEN_STRONG_INLINE Packet2cf Eigen::internal::pload< Packet2cf > ( const std::complex< float > *  from)

Definition at line 76 of file AltiVec/Complex.h.

◆ pload< Packet2d >()

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::pload< Packet2d > ( const double *  from)

Definition at line 307 of file SSE/PacketMath.h.

◆ pload< Packet4cf >()

template<>
EIGEN_STRONG_INLINE Packet4cf Eigen::internal::pload< Packet4cf > ( const std::complex< float > *  from)

Definition at line 75 of file AVX/Complex.h.

◆ pload< Packet4d >()

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::pload< Packet4d > ( const double *  from)

Definition at line 214 of file AVX/PacketMath.h.

◆ pload< Packet4f >()

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::pload< Packet4f > ( const float *  from)

Definition at line 239 of file AltiVec/PacketMath.h.

◆ pload< Packet4i >()

template<>
EIGEN_STRONG_INLINE Packet4i Eigen::internal::pload< Packet4i > ( const int *  from)

Definition at line 249 of file AltiVec/PacketMath.h.

◆ pload< Packet8d >()

template<>
EIGEN_STRONG_INLINE Packet8d Eigen::internal::pload< Packet8d > ( const double *  from)

Definition at line 437 of file AVX512/PacketMath.h.

◆ pload< Packet8f >()

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::pload< Packet8f > ( const float *  from)

Definition at line 213 of file AVX/PacketMath.h.

◆ pload< Packet8i >()

template<>
EIGEN_STRONG_INLINE Packet8i Eigen::internal::pload< Packet8i > ( const int *  from)

Definition at line 215 of file AVX/PacketMath.h.

◆ ploaddup()

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::ploaddup ( const typename unpacket_traits< Packet >::type *  from)
inline

Definition at line 234 of file GenericPacketMath.h.

◆ ploaddup< Packet16f >()

template<>
EIGEN_STRONG_INLINE Packet16f Eigen::internal::ploaddup< Packet16f > ( const float *  from)

Definition at line 463 of file AVX512/PacketMath.h.

◆ ploaddup< Packet1cd >()

template<>
EIGEN_STRONG_INLINE Packet1cd Eigen::internal::ploaddup< Packet1cd > ( const std::complex< double > *  from)

Definition at line 337 of file SSE/Complex.h.

◆ ploaddup< Packet2cd >()

template<>
EIGEN_STRONG_INLINE Packet2cd Eigen::internal::ploaddup< Packet2cd > ( const std::complex< double > *  from)

Definition at line 308 of file AVX/Complex.h.

◆ ploaddup< Packet2cf >()

template<>
EIGEN_STRONG_INLINE Packet2cf Eigen::internal::ploaddup< Packet2cf > ( const std::complex< float > *  from)

Definition at line 78 of file AltiVec/Complex.h.

◆ ploaddup< Packet2d >()

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::ploaddup< Packet2d > ( const double *  from)

Definition at line 349 of file SSE/PacketMath.h.

◆ ploaddup< Packet4cf >()

template<>
EIGEN_STRONG_INLINE Packet4cf Eigen::internal::ploaddup< Packet4cf > ( const std::complex< float > *  from)

Definition at line 84 of file AVX/Complex.h.

◆ ploaddup< Packet4d >()

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::ploaddup< Packet4d > ( const double *  from)

Definition at line 237 of file AVX/PacketMath.h.

◆ ploaddup< Packet4f >()

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::ploaddup< Packet4f > ( const float *  from)

Definition at line 450 of file AltiVec/PacketMath.h.

◆ ploaddup< Packet4i >()

template<>
EIGEN_STRONG_INLINE Packet4i Eigen::internal::ploaddup< Packet4i > ( const int *  from)

Definition at line 457 of file AltiVec/PacketMath.h.

◆ ploaddup< Packet8d >()

template<>
EIGEN_STRONG_INLINE Packet8d Eigen::internal::ploaddup< Packet8d > ( const double *  from)

Definition at line 501 of file AVX512/PacketMath.h.

◆ ploaddup< Packet8f >()

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::ploaddup< Packet8f > ( const float *  from)

Definition at line 222 of file AVX/PacketMath.h.

◆ ploadquad()

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::ploadquad ( const typename unpacket_traits< Packet >::type *  from)
inline

Definition at line 243 of file GenericPacketMath.h.

◆ ploadquad< Packet16f >()

template<>
EIGEN_STRONG_INLINE Packet16f Eigen::internal::ploadquad< Packet16f > ( const float *  from)

Definition at line 516 of file AVX512/PacketMath.h.

◆ ploadquad< Packet8d >()

template<>
EIGEN_STRONG_INLINE Packet8d Eigen::internal::ploadquad< Packet8d > ( const double *  from)

Definition at line 527 of file AVX512/PacketMath.h.

◆ ploadquad< Packet8f >()

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::ploadquad< Packet8f > ( const float *  from)

Definition at line 244 of file AVX/PacketMath.h.

◆ ploadt()

template<typename Packet , int Alignment>
EIGEN_DEVICE_FUNC EIGEN_ALWAYS_INLINE Packet Eigen::internal::ploadt ( const typename unpacket_traits< Packet >::type *  from)

Definition at line 460 of file GenericPacketMath.h.

◆ ploadt_ro()

template<typename Packet , int LoadMode>
Packet Eigen::internal::ploadt_ro ( const typename unpacket_traits< Packet >::type *  from)
inline

Definition at line 485 of file GenericPacketMath.h.

◆ ploadu()

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::ploadu ( const typename unpacket_traits< Packet >::type *  from)
inline

Definition at line 218 of file GenericPacketMath.h.

◆ ploadu< Packet16f >()

template<>
EIGEN_STRONG_INLINE Packet16f Eigen::internal::ploadu< Packet16f > ( const float *  from)

Definition at line 447 of file AVX512/PacketMath.h.

◆ ploadu< Packet16i >()

template<>
EIGEN_STRONG_INLINE Packet16i Eigen::internal::ploadu< Packet16i > ( const int *  from)

Definition at line 455 of file AVX512/PacketMath.h.

◆ ploadu< Packet1cd >()

template<>
EIGEN_STRONG_INLINE Packet1cd Eigen::internal::ploadu< Packet1cd > ( const std::complex< double > *  from)

Definition at line 332 of file SSE/Complex.h.

◆ ploadu< Packet2cd >()

template<>
EIGEN_STRONG_INLINE Packet2cd Eigen::internal::ploadu< Packet2cd > ( const std::complex< double > *  from)

Definition at line 298 of file AVX/Complex.h.

◆ ploadu< Packet2cf >()

template<>
EIGEN_STRONG_INLINE Packet2cf Eigen::internal::ploadu< Packet2cf > ( const std::complex< float > *  from)

Definition at line 77 of file AltiVec/Complex.h.

◆ ploadu< Packet2d >()

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::ploadu< Packet2d > ( const double *  from)

Definition at line 333 of file SSE/PacketMath.h.

◆ ploadu< Packet4cf >()

template<>
EIGEN_STRONG_INLINE Packet4cf Eigen::internal::ploadu< Packet4cf > ( const std::complex< float > *  from)

Definition at line 76 of file AVX/Complex.h.

◆ ploadu< Packet4d >()

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::ploadu< Packet4d > ( const double *  from)

Definition at line 218 of file AVX/PacketMath.h.

◆ ploadu< Packet4f >()

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::ploadu< Packet4f > ( const float *  from)

Definition at line 443 of file AltiVec/PacketMath.h.

◆ ploadu< Packet4i >()

template<>
EIGEN_STRONG_INLINE Packet4i Eigen::internal::ploadu< Packet4i > ( const int *  from)

Definition at line 438 of file AltiVec/PacketMath.h.

◆ ploadu< Packet8d >()

template<>
EIGEN_STRONG_INLINE Packet8d Eigen::internal::ploadu< Packet8d > ( const double *  from)

Definition at line 451 of file AVX512/PacketMath.h.

◆ ploadu< Packet8f >()

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::ploadu< Packet8f > ( const float *  from)

Definition at line 217 of file AVX/PacketMath.h.

◆ ploadu< Packet8i >()

template<>
EIGEN_STRONG_INLINE Packet8i Eigen::internal::ploadu< Packet8i > ( const int *  from)

Definition at line 219 of file AVX/PacketMath.h.

◆ plog()

template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet Eigen::internal::plog ( const Packet a)

Definition at line 406 of file GenericPacketMath.h.

◆ plog10()

template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet Eigen::internal::plog10 ( const Packet a)

Definition at line 414 of file GenericPacketMath.h.

◆ plog1p()

template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet Eigen::internal::plog1p ( const Packet a)

Definition at line 410 of file GenericPacketMath.h.

◆ plog< Packet4f >()

Definition at line 93 of file arch/AltiVec/MathFunctions.h.

◆ plog< Packet8f >()

Definition at line 121 of file arch/AVX/MathFunctions.h.

◆ plset()

template<typename Packet >
Packet Eigen::internal::plset ( const typename unpacket_traits< Packet >::type &  a)
inline

Definition at line 282 of file GenericPacketMath.h.

◆ plset< Packet16f >()

template<>
EIGEN_STRONG_INLINE Packet16f Eigen::internal::plset< Packet16f > ( const float &  a)

Definition at line 139 of file AVX512/PacketMath.h.

◆ plset< Packet2d >()

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::plset< Packet2d > ( const double &  a)

Definition at line 195 of file SSE/PacketMath.h.

◆ plset< Packet4d >()

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::plset< Packet4d > ( const double &  a)

Definition at line 128 of file AVX/PacketMath.h.

◆ plset< Packet4f >()

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::plset< Packet4f > ( const float &  a)

Definition at line 346 of file AltiVec/PacketMath.h.

◆ plset< Packet4i >()

template<>
EIGEN_STRONG_INLINE Packet4i Eigen::internal::plset< Packet4i > ( const int &  a)

Definition at line 347 of file AltiVec/PacketMath.h.

◆ plset< Packet8d >()

template<>
EIGEN_STRONG_INLINE Packet8d Eigen::internal::plset< Packet8d > ( const double &  a)

Definition at line 146 of file AVX512/PacketMath.h.

◆ plset< Packet8f >()

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::plset< Packet8f > ( const float &  a)

Definition at line 127 of file AVX/PacketMath.h.

◆ pmadd() [1/4]

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::pmadd ( const Packet4f a,
const Packet4f b,
const Packet4f c 
)

Definition at line 388 of file AltiVec/PacketMath.h.

◆ pmadd() [2/4]

template<>
EIGEN_STRONG_INLINE Packet4i Eigen::internal::pmadd ( const Packet4i a,
const Packet4i b,
const Packet4i c 
)

Definition at line 389 of file AltiVec/PacketMath.h.

◆ pmadd() [3/4]

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::pmadd ( const Packet a,
const Packet b,
const Packet c 
)
inline

Definition at line 452 of file GenericPacketMath.h.

◆ pmadd() [4/4]

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::pmadd ( const Packet2d a,
const Packet2d b,
const Packet2d c 
)

Definition at line 560 of file ZVector/PacketMath.h.

◆ pmax()

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::pmax ( const Packet a,
const Packet b 
)
inline

Definition at line 185 of file GenericPacketMath.h.

◆ pmax< Packet16f >()

template<>
EIGEN_STRONG_INLINE Packet16f Eigen::internal::pmax< Packet16f > ( const Packet16f a,
const Packet16f b 
)

Definition at line 242 of file AVX512/PacketMath.h.

◆ pmax< Packet2d >()

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::pmax< Packet2d > ( const Packet2d a,
const Packet2d b 
)

Definition at line 267 of file SSE/PacketMath.h.

◆ pmax< Packet4d >()

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::pmax< Packet4d > ( const Packet4d a,
const Packet4d b 
)

Definition at line 190 of file AVX/PacketMath.h.

◆ pmax< Packet4f >()

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::pmax< Packet4f > ( const Packet4f a,
const Packet4f b 
)

Definition at line 394 of file AltiVec/PacketMath.h.

◆ pmax< Packet4i >()

template<>
EIGEN_STRONG_INLINE Packet4i Eigen::internal::pmax< Packet4i > ( const Packet4i a,
const Packet4i b 
)

Definition at line 395 of file AltiVec/PacketMath.h.

◆ pmax< Packet8d >()

template<>
EIGEN_STRONG_INLINE Packet8d Eigen::internal::pmax< Packet8d > ( const Packet8d a,
const Packet8d b 
)

Definition at line 247 of file AVX512/PacketMath.h.

◆ pmax< Packet8f >()

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::pmax< Packet8f > ( const Packet8f a,
const Packet8f b 
)

Definition at line 189 of file AVX/PacketMath.h.

◆ pmin()

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::pmin ( const Packet a,
const Packet b 
)
inline

Definition at line 180 of file GenericPacketMath.h.

◆ pmin< Packet16f >()

template<>
EIGEN_STRONG_INLINE Packet16f Eigen::internal::pmin< Packet16f > ( const Packet16f a,
const Packet16f b 
)

Definition at line 231 of file AVX512/PacketMath.h.

◆ pmin< Packet2d >()

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::pmin< Packet2d > ( const Packet2d a,
const Packet2d b 
)

Definition at line 254 of file SSE/PacketMath.h.

◆ pmin< Packet4d >()

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::pmin< Packet4d > ( const Packet4d a,
const Packet4d b 
)

Definition at line 187 of file AVX/PacketMath.h.

◆ pmin< Packet4f >()

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::pmin< Packet4f > ( const Packet4f a,
const Packet4f b 
)

Definition at line 391 of file AltiVec/PacketMath.h.

◆ pmin< Packet4i >()

template<>
EIGEN_STRONG_INLINE Packet4i Eigen::internal::pmin< Packet4i > ( const Packet4i a,
const Packet4i b 
)

Definition at line 392 of file AltiVec/PacketMath.h.

◆ pmin< Packet8d >()

template<>
EIGEN_STRONG_INLINE Packet8d Eigen::internal::pmin< Packet8d > ( const Packet8d a,
const Packet8d b 
)

Definition at line 236 of file AVX512/PacketMath.h.

◆ pmin< Packet8f >()

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::pmin< Packet8f > ( const Packet8f a,
const Packet8f b 
)

Definition at line 186 of file AVX/PacketMath.h.

◆ pmul() [1/3]

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::pmul ( const Packet a,
const Packet b 
)
inline

Definition at line 170 of file GenericPacketMath.h.

◆ pmul() [2/3]

template<>
std::complex<float> Eigen::internal::pmul ( const std::complex< float > &  a,
const std::complex< float > &  b 
)
inline

Definition at line 526 of file GenericPacketMath.h.

◆ pmul() [3/3]

template<>
std::complex<double> Eigen::internal::pmul ( const std::complex< double > &  a,
const std::complex< double > &  b 
)
inline

Definition at line 529 of file GenericPacketMath.h.

◆ pmul< Packet16f >()

template<>
EIGEN_STRONG_INLINE Packet16f Eigen::internal::pmul< Packet16f > ( const Packet16f a,
const Packet16f b 
)

Definition at line 196 of file AVX512/PacketMath.h.

◆ pmul< Packet1cd >()

template<>
EIGEN_STRONG_INLINE Packet1cd Eigen::internal::pmul< Packet1cd > ( const Packet1cd a,
const Packet1cd b 
)

Definition at line 310 of file SSE/Complex.h.

◆ pmul< Packet2cd >()

template<>
EIGEN_STRONG_INLINE Packet2cd Eigen::internal::pmul< Packet2cd > ( const Packet2cd a,
const Packet2cd b 
)

Definition at line 281 of file AVX/Complex.h.

◆ pmul< Packet2cf >()

template<>
EIGEN_STRONG_INLINE Packet2cf Eigen::internal::pmul< Packet2cf > ( const Packet2cf a,
const Packet2cf b 
)

Definition at line 103 of file AltiVec/Complex.h.

◆ pmul< Packet2d >()

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::pmul< Packet2d > ( const Packet2d a,
const Packet2d b 
)

Definition at line 226 of file SSE/PacketMath.h.

◆ pmul< Packet4cf >()

template<>
EIGEN_STRONG_INLINE Packet4cf Eigen::internal::pmul< Packet4cf > ( const Packet4cf a,
const Packet4cf b 
)

Definition at line 62 of file AVX/Complex.h.

◆ pmul< Packet4d >()

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::pmul< Packet4d > ( const Packet4d a,
const Packet4d b 
)

Definition at line 150 of file AVX/PacketMath.h.

◆ pmul< Packet4f >()

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::pmul< Packet4f > ( const Packet4f a,
const Packet4f b 
)

Definition at line 361 of file AltiVec/PacketMath.h.

◆ pmul< Packet4i >()

template<>
EIGEN_STRONG_INLINE Packet4i Eigen::internal::pmul< Packet4i > ( const Packet4i a,
const Packet4i b 
)

Definition at line 362 of file AltiVec/PacketMath.h.

◆ pmul< Packet8d >()

template<>
EIGEN_STRONG_INLINE Packet8d Eigen::internal::pmul< Packet8d > ( const Packet8d a,
const Packet8d b 
)

Definition at line 201 of file AVX512/PacketMath.h.

◆ pmul< Packet8f >()

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::pmul< Packet8f > ( const Packet8f a,
const Packet8f b 
)

Definition at line 149 of file AVX/PacketMath.h.

◆ pnegate() [1/12]

template<>
EIGEN_STRONG_INLINE Packet4cf Eigen::internal::pnegate ( const Packet4cf a)

Definition at line 52 of file AVX/Complex.h.

◆ pnegate() [2/12]

template<>
EIGEN_STRONG_INLINE Packet2cf Eigen::internal::pnegate ( const Packet2cf a)

Definition at line 100 of file AltiVec/Complex.h.

◆ pnegate() [3/12]

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::pnegate ( const Packet8f a)

Definition at line 136 of file AVX/PacketMath.h.

◆ pnegate() [4/12]

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::pnegate ( const Packet4d a)

Definition at line 140 of file AVX/PacketMath.h.

◆ pnegate() [5/12]

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::pnegate ( const Packet a)
inline

Definition at line 161 of file GenericPacketMath.h.

◆ pnegate() [6/12]

template<>
EIGEN_STRONG_INLINE Packet16f Eigen::internal::pnegate ( const Packet16f a)

Definition at line 174 of file AVX512/PacketMath.h.

◆ pnegate() [7/12]

template<>
EIGEN_STRONG_INLINE Packet8d Eigen::internal::pnegate ( const Packet8d a)

Definition at line 178 of file AVX512/PacketMath.h.

◆ pnegate() [8/12]

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::pnegate ( const Packet2d a)

Definition at line 211 of file SSE/PacketMath.h.

◆ pnegate() [9/12]

template<>
EIGEN_STRONG_INLINE Packet2cd Eigen::internal::pnegate ( const Packet2cd a)

Definition at line 274 of file AVX/Complex.h.

◆ pnegate() [10/12]

template<>
EIGEN_STRONG_INLINE Packet1cd Eigen::internal::pnegate ( const Packet1cd a)

Definition at line 303 of file SSE/Complex.h.

◆ pnegate() [11/12]

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::pnegate ( const Packet4f a)

Definition at line 355 of file AltiVec/PacketMath.h.

◆ pnegate() [12/12]

template<>
EIGEN_STRONG_INLINE Packet4i Eigen::internal::pnegate ( const Packet4i a)

Definition at line 356 of file AltiVec/PacketMath.h.

◆ por()

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::por ( const Packet a,
const Packet b 
)
inline

Definition at line 202 of file GenericPacketMath.h.

◆ por< Packet16f >()

template<>
EIGEN_STRONG_INLINE Packet16f Eigen::internal::por< Packet16f > ( const Packet16f a,
const Packet16f b 
)

Definition at line 297 of file AVX512/PacketMath.h.

◆ por< Packet1cd >()

template<>
EIGEN_STRONG_INLINE Packet1cd Eigen::internal::por< Packet1cd > ( const Packet1cd a,
const Packet1cd b 
)

Definition at line 325 of file SSE/Complex.h.

◆ por< Packet2cd >()

template<>
EIGEN_STRONG_INLINE Packet2cd Eigen::internal::por< Packet2cd > ( const Packet2cd a,
const Packet2cd b 
)

Definition at line 292 of file AVX/Complex.h.

◆ por< Packet2cf >()

template<>
EIGEN_STRONG_INLINE Packet2cf Eigen::internal::por< Packet2cf > ( const Packet2cf a,
const Packet2cf b 
)

Definition at line 123 of file AltiVec/Complex.h.

◆ por< Packet2d >()

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::por< Packet2d > ( const Packet2d a,
const Packet2d b 
)

Definition at line 295 of file SSE/PacketMath.h.

◆ por< Packet4cf >()

template<>
EIGEN_STRONG_INLINE Packet4cf Eigen::internal::por< Packet4cf > ( const Packet4cf a,
const Packet4cf b 
)

Definition at line 71 of file AVX/Complex.h.

◆ por< Packet4d >()

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::por< Packet4d > ( const Packet4d a,
const Packet4d b 
)

Definition at line 205 of file AVX/PacketMath.h.

◆ por< Packet4f >()

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::por< Packet4f > ( const Packet4f a,
const Packet4f b 
)

Definition at line 400 of file AltiVec/PacketMath.h.

◆ por< Packet4i >()

template<>
EIGEN_STRONG_INLINE Packet4i Eigen::internal::por< Packet4i > ( const Packet4i a,
const Packet4i b 
)

Definition at line 401 of file AltiVec/PacketMath.h.

◆ por< Packet8d >()

template<>
EIGEN_STRONG_INLINE Packet8d Eigen::internal::por< Packet8d > ( const Packet8d a,
const Packet8d b 
)

Definition at line 324 of file AVX512/PacketMath.h.

◆ por< Packet8f >()

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::por< Packet8f > ( const Packet8f a,
const Packet8f b 
)

Definition at line 204 of file AVX/PacketMath.h.

◆ predux()

template<typename Packet >
EIGEN_DEVICE_FUNC unpacket_traits<Packet>::type Eigen::internal::predux ( const Packet a)
inline

Definition at line 323 of file GenericPacketMath.h.

◆ predux< Packet16f >()

template<>
EIGEN_STRONG_INLINE float Eigen::internal::predux< Packet16f > ( const Packet16f a)

Definition at line 878 of file AVX512/PacketMath.h.

◆ predux< Packet1cd >()

template<>
EIGEN_STRONG_INLINE std::complex< double > Eigen::internal::predux< Packet1cd > ( const Packet1cd a)

Definition at line 354 of file SSE/Complex.h.

◆ predux< Packet2cd >()

template<>
EIGEN_STRONG_INLINE std::complex<double> Eigen::internal::predux< Packet2cd > ( const Packet2cd a)

Definition at line 340 of file AVX/Complex.h.

◆ predux< Packet2cf >()

template<>
EIGEN_STRONG_INLINE std::complex< float > Eigen::internal::predux< Packet2cf > ( const Packet2cf a)

Definition at line 144 of file AltiVec/Complex.h.

◆ predux< Packet2d >()

template<>
EIGEN_STRONG_INLINE double Eigen::internal::predux< Packet2d > ( const Packet2d a)

Definition at line 526 of file SSE/PacketMath.h.

◆ predux< Packet4cf >()

template<>
EIGEN_STRONG_INLINE std::complex<float> Eigen::internal::predux< Packet4cf > ( const Packet4cf a)

Definition at line 137 of file AVX/Complex.h.

◆ predux< Packet4d >()

template<>
EIGEN_STRONG_INLINE double Eigen::internal::predux< Packet4d > ( const Packet4d a)

Definition at line 402 of file AVX/PacketMath.h.

◆ predux< Packet4f >()

template<>
EIGEN_STRONG_INLINE float Eigen::internal::predux< Packet4f > ( const Packet4f a)

Definition at line 533 of file AltiVec/PacketMath.h.

◆ predux< Packet4i >()

Definition at line 571 of file AltiVec/PacketMath.h.

◆ predux< Packet8d >()

template<>
EIGEN_STRONG_INLINE double Eigen::internal::predux< Packet8d > ( const Packet8d a)

Definition at line 899 of file AVX512/PacketMath.h.

◆ predux< Packet8f >()

template<>
EIGEN_STRONG_INLINE float Eigen::internal::predux< Packet8f > ( const Packet8f a)

Definition at line 396 of file AVX/PacketMath.h.

◆ predux_downto4() [1/2]

template<typename Packet >
EIGEN_DEVICE_FUNC conditional<(unpacket_traits<Packet>::size%8)==0,typename unpacket_traits<Packet>::half,Packet>::type Eigen::internal::predux_downto4 ( const Packet a)
inline

Definition at line 332 of file GenericPacketMath.h.

◆ predux_downto4() [2/2]

template<typename Packet >
const DoublePacket<Packet>& Eigen::internal::predux_downto4 ( const DoublePacket< Packet > &  a)

Definition at line 583 of file GeneralBlockPanelKernel.h.

◆ predux_downto4< Packet16f >()

Definition at line 908 of file AVX512/PacketMath.h.

◆ predux_downto4< Packet8d >()

Definition at line 924 of file AVX512/PacketMath.h.

◆ predux_downto4< Packet8f >()

Definition at line 408 of file AVX/PacketMath.h.

◆ predux_max()

template<typename Packet >
EIGEN_DEVICE_FUNC unpacket_traits<Packet>::type Eigen::internal::predux_max ( const Packet a)
inline

Definition at line 344 of file GenericPacketMath.h.

◆ predux_max< Packet16f >()

Definition at line 980 of file AVX512/PacketMath.h.

◆ predux_max< Packet2d >()

Definition at line 637 of file SSE/PacketMath.h.

◆ predux_max< Packet4d >()

Definition at line 446 of file AVX/PacketMath.h.

◆ predux_max< Packet4f >()

Definition at line 645 of file AltiVec/PacketMath.h.

◆ predux_max< Packet4i >()

Definition at line 653 of file AltiVec/PacketMath.h.

◆ predux_max< Packet8d >()

Definition at line 990 of file AVX512/PacketMath.h.

◆ predux_max< Packet8f >()

Definition at line 439 of file AVX/PacketMath.h.

◆ predux_min()

template<typename Packet >
EIGEN_DEVICE_FUNC unpacket_traits<Packet>::type Eigen::internal::predux_min ( const Packet a)
inline

Definition at line 340 of file GenericPacketMath.h.

◆ predux_min< Packet16f >()

Definition at line 961 of file AVX512/PacketMath.h.

◆ predux_min< Packet2d >()

Definition at line 611 of file SSE/PacketMath.h.

◆ predux_min< Packet4d >()

Definition at line 433 of file AVX/PacketMath.h.

◆ predux_min< Packet4f >()

Definition at line 628 of file AltiVec/PacketMath.h.

◆ predux_min< Packet4i >()

Definition at line 636 of file AltiVec/PacketMath.h.

◆ predux_min< Packet8d >()

Definition at line 971 of file AVX512/PacketMath.h.

◆ predux_min< Packet8f >()

Definition at line 427 of file AVX/PacketMath.h.

◆ predux_mul()

template<typename Packet >
EIGEN_DEVICE_FUNC unpacket_traits<Packet>::type Eigen::internal::predux_mul ( const Packet a)
inline

Definition at line 336 of file GenericPacketMath.h.

◆ predux_mul< Packet16f >()

Definition at line 932 of file AVX512/PacketMath.h.

◆ predux_mul< Packet1cd >()

template<>
EIGEN_STRONG_INLINE std::complex< double > Eigen::internal::predux_mul< Packet1cd > ( const Packet1cd a)

Definition at line 364 of file SSE/Complex.h.

◆ predux_mul< Packet2cd >()

template<>
EIGEN_STRONG_INLINE std::complex<double> Eigen::internal::predux_mul< Packet2cd > ( const Packet2cd a)

Definition at line 354 of file AVX/Complex.h.

◆ predux_mul< Packet2cf >()

template<>
EIGEN_STRONG_INLINE std::complex< float > Eigen::internal::predux_mul< Packet2cf > ( const Packet2cf a)

Definition at line 168 of file AltiVec/Complex.h.

◆ predux_mul< Packet2d >()

Definition at line 591 of file SSE/PacketMath.h.

◆ predux_mul< Packet4cf >()

template<>
EIGEN_STRONG_INLINE std::complex<float> Eigen::internal::predux_mul< Packet4cf > ( const Packet4cf a)

Definition at line 158 of file AVX/Complex.h.

◆ predux_mul< Packet4d >()

Definition at line 420 of file AVX/PacketMath.h.

◆ predux_mul< Packet4f >()

Definition at line 613 of file AltiVec/PacketMath.h.

◆ predux_mul< Packet4i >()

Definition at line 620 of file AltiVec/PacketMath.h.

◆ predux_mul< Packet8d >()

Definition at line 952 of file AVX512/PacketMath.h.

◆ predux_mul< Packet8f >()

Definition at line 413 of file AVX/PacketMath.h.

◆ preduxp()

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::preduxp ( const Packet vecs)
inline

Definition at line 320 of file GenericPacketMath.h.

◆ preduxp< Packet16f >()

Definition at line 686 of file AVX512/PacketMath.h.

◆ preduxp< Packet1cd >()

Definition at line 359 of file SSE/Complex.h.

◆ preduxp< Packet2cd >()

Definition at line 346 of file AVX/Complex.h.

◆ preduxp< Packet2cf >()

Definition at line 152 of file AltiVec/Complex.h.

◆ preduxp< Packet2d >()

Definition at line 545 of file SSE/PacketMath.h.

◆ preduxp< Packet4cf >()

Definition at line 143 of file AVX/Complex.h.

◆ preduxp< Packet4d >()

Definition at line 383 of file AVX/PacketMath.h.

◆ preduxp< Packet4f >()

Definition at line 543 of file AltiVec/PacketMath.h.

◆ preduxp< Packet4i >()

Definition at line 583 of file AltiVec/PacketMath.h.

◆ preduxp< Packet8d >()

Definition at line 812 of file AVX512/PacketMath.h.

◆ preduxp< Packet8f >()

Definition at line 355 of file AVX/PacketMath.h.

◆ prefetch()

template<typename Scalar >
EIGEN_DEVICE_FUNC void Eigen::internal::prefetch ( const Scalar *  addr)
inline

Definition at line 299 of file GenericPacketMath.h.

◆ prefetch< double >()

template<>
EIGEN_STRONG_INLINE void Eigen::internal::prefetch< double > ( const double *  addr)

Definition at line 312 of file AVX/PacketMath.h.

◆ prefetch< float >()

template<>
EIGEN_STRONG_INLINE void Eigen::internal::prefetch< float > ( const float *  addr)

Definition at line 516 of file AltiVec/PacketMath.h.

◆ prefetch< int >()

template<>
EIGEN_STRONG_INLINE void Eigen::internal::prefetch< int > ( const int *  addr)

Definition at line 517 of file AltiVec/PacketMath.h.

◆ prefetch< std::complex< double > >()

template<>
EIGEN_STRONG_INLINE void Eigen::internal::prefetch< std::complex< double > > ( const std::complex< double > *  addr)

Definition at line 343 of file SSE/Complex.h.

◆ prefetch< std::complex< float > >()

template<>
EIGEN_STRONG_INLINE void Eigen::internal::prefetch< std::complex< float > > ( const std::complex< float > *  addr)

Definition at line 127 of file AltiVec/Complex.h.

◆ preverse() [1/12]

template<>
EIGEN_STRONG_INLINE Packet4cf Eigen::internal::preverse ( const Packet4cf a)

Definition at line 124 of file AVX/Complex.h.

◆ preverse() [2/12]

template<>
EIGEN_STRONG_INLINE Packet2cf Eigen::internal::preverse ( const Packet2cf a)

Definition at line 137 of file AltiVec/Complex.h.

◆ preverse() [3/12]

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::preverse ( const Packet8f a)

Definition at line 327 of file AVX/PacketMath.h.

◆ preverse() [4/12]

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::preverse ( const Packet4d a)

Definition at line 332 of file AVX/PacketMath.h.

◆ preverse() [5/12]

template<>
EIGEN_STRONG_INLINE Packet2cd Eigen::internal::preverse ( const Packet2cd a)

Definition at line 335 of file AVX/Complex.h.

◆ preverse() [6/12]

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::preverse ( const Packet a)
inline

Definition at line 348 of file GenericPacketMath.h.

◆ preverse() [7/12]

template<>
EIGEN_STRONG_INLINE Packet1cd Eigen::internal::preverse ( const Packet1cd a)

Definition at line 352 of file SSE/Complex.h.

◆ preverse() [8/12]

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::preverse ( const Packet2d a)

Definition at line 437 of file SSE/PacketMath.h.

◆ preverse() [9/12]

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::preverse ( const Packet4f a)

Definition at line 522 of file AltiVec/PacketMath.h.

◆ preverse() [10/12]

template<>
EIGEN_STRONG_INLINE Packet4i Eigen::internal::preverse ( const Packet4i a)

Definition at line 526 of file AltiVec/PacketMath.h.

◆ preverse() [11/12]

template<>
EIGEN_STRONG_INLINE Packet16f Eigen::internal::preverse ( const Packet16f a)

Definition at line 638 of file AVX512/PacketMath.h.

◆ preverse() [12/12]

template<>
EIGEN_STRONG_INLINE Packet8d Eigen::internal::preverse ( const Packet8d a)

Definition at line 643 of file AVX512/PacketMath.h.

◆ print_matrix()

template<typename Derived >
std::ostream & Eigen::internal::print_matrix ( std::ostream &  s,
const Derived &  _m,
const IOFormat fmt 
)

Definition at line 143 of file IO.h.

◆ pround()

template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet Eigen::internal::pround ( const Packet a)

Definition at line 428 of file GenericPacketMath.h.

◆ pround< Packet2d >()

Definition at line 633 of file ZVector/PacketMath.h.

◆ pround< Packet4d >()

Definition at line 193 of file AVX/PacketMath.h.

◆ pround< Packet4f >()

Definition at line 409 of file AltiVec/PacketMath.h.

◆ pround< Packet8f >()

Definition at line 192 of file AVX/PacketMath.h.

◆ prsqrt()

template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet Eigen::internal::prsqrt ( const Packet a)

Definition at line 422 of file GenericPacketMath.h.

◆ prsqrt< Packet2d >()

Definition at line 522 of file arch/SSE/MathFunctions.h.

◆ prsqrt< Packet4d >()

Definition at line 429 of file arch/AVX/MathFunctions.h.

◆ prsqrt< Packet4f >()

Definition at line 199 of file arch/AltiVec/MathFunctions.h.

◆ prsqrt< Packet8f >()

Definition at line 422 of file arch/AVX/MathFunctions.h.

◆ pscatter()

template<typename Scalar , typename Packet >
EIGEN_DEVICE_FUNC void Eigen::internal::pscatter ( Scalar *  to,
const Packet from,
Index   
)
inline

Definition at line 295 of file GenericPacketMath.h.

◆ pscatter< double, Packet2d >()

template<>
EIGEN_DEVICE_FUNC void Eigen::internal::pscatter< double, Packet2d > ( double *  to,
const Packet2d from,
Index  stride 
)
inline

Definition at line 386 of file SSE/PacketMath.h.

◆ pscatter< double, Packet4d >()

template<>
EIGEN_DEVICE_FUNC void Eigen::internal::pscatter< double, Packet4d > ( double *  to,
const Packet4d from,
Index  stride 
)
inline

Definition at line 284 of file AVX/PacketMath.h.

◆ pscatter< double, Packet8d >()

template<>
EIGEN_DEVICE_FUNC void Eigen::internal::pscatter< double, Packet8d > ( double *  to,
const Packet8d from,
Index  stride 
)
inline

Definition at line 596 of file AVX512/PacketMath.h.

◆ pscatter< float, Packet16f >()

template<>
EIGEN_DEVICE_FUNC void Eigen::internal::pscatter< float, Packet16f > ( float *  to,
const Packet16f from,
Index  stride 
)
inline

Definition at line 586 of file AVX512/PacketMath.h.

◆ pscatter< float, Packet4f >()

template<>
EIGEN_DEVICE_FUNC void Eigen::internal::pscatter< float, Packet4f > ( float *  to,
const Packet4f from,
Index  stride 
)
inline

Definition at line 327 of file AltiVec/PacketMath.h.

◆ pscatter< float, Packet8f >()

template<>
EIGEN_DEVICE_FUNC void Eigen::internal::pscatter< float, Packet8f > ( float *  to,
const Packet8f from,
Index  stride 
)
inline

Definition at line 270 of file AVX/PacketMath.h.

◆ pscatter< int, Packet4i >()

template<>
EIGEN_DEVICE_FUNC void Eigen::internal::pscatter< int, Packet4i > ( int *  to,
const Packet4i from,
Index  stride 
)
inline

Definition at line 336 of file AltiVec/PacketMath.h.

◆ pscatter< std::complex< double >, Packet1cd >()

template<>
EIGEN_DEVICE_FUNC void Eigen::internal::pscatter< std::complex< double >, Packet1cd > ( std::complex< double > *  to,
const Packet1cd from,
Index stride  EIGEN_UNUSED 
)
inline

Definition at line 129 of file ZVector/Complex.h.

◆ pscatter< std::complex< double >, Packet2cd >()

template<>
EIGEN_DEVICE_FUNC void Eigen::internal::pscatter< std::complex< double >, Packet2cd > ( std::complex< double > *  to,
const Packet2cd from,
Index  stride 
)
inline

Definition at line 319 of file AVX/Complex.h.

◆ pscatter< std::complex< float >, Packet2cf >()

template<>
EIGEN_DEVICE_FUNC void Eigen::internal::pscatter< std::complex< float >, Packet2cf > ( std::complex< float > *  to,
const Packet2cf from,
Index  stride 
)
inline

Definition at line 90 of file AltiVec/Complex.h.

◆ pscatter< std::complex< float >, Packet4cf >()

template<>
EIGEN_DEVICE_FUNC void Eigen::internal::pscatter< std::complex< float >, Packet4cf > ( std::complex< float > *  to,
const Packet4cf from,
Index  stride 
)
inline

Definition at line 103 of file AVX/Complex.h.

◆ pset1()

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::pset1 ( const typename unpacket_traits< Packet >::type &  a)
inline

Definition at line 222 of file GenericPacketMath.h.

◆ pset1< Packet16f >()

template<>
EIGEN_STRONG_INLINE Packet16f Eigen::internal::pset1< Packet16f > ( const float &  from)

Definition at line 117 of file AVX512/PacketMath.h.

◆ pset1< Packet16i >()

template<>
EIGEN_STRONG_INLINE Packet16i Eigen::internal::pset1< Packet16i > ( const int &  from)

Definition at line 125 of file AVX512/PacketMath.h.

◆ pset1< Packet1cd >()

template<>
EIGEN_STRONG_INLINE Packet1cd Eigen::internal::pset1< Packet1cd > ( const std::complex< double > &  from)

Definition at line 334 of file SSE/Complex.h.

◆ pset1< Packet2cd >()

template<>
EIGEN_STRONG_INLINE Packet2cd Eigen::internal::pset1< Packet2cd > ( const std::complex< double > &  from)

Definition at line 301 of file AVX/Complex.h.

◆ pset1< Packet2cf >()

template<>
EIGEN_STRONG_INLINE Packet2cf Eigen::internal::pset1< Packet2cf > ( const std::complex< float > &  from)

Definition at line 65 of file AltiVec/Complex.h.

◆ pset1< Packet2d >()

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::pset1< Packet2d > ( const double &  from)

Definition at line 179 of file SSE/PacketMath.h.

◆ pset1< Packet4cf >()

template<>
EIGEN_STRONG_INLINE Packet4cf Eigen::internal::pset1< Packet4cf > ( const std::complex< float > &  from)

Definition at line 79 of file AVX/Complex.h.

◆ pset1< Packet4d >()

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::pset1< Packet4d > ( const double &  from)

Definition at line 121 of file AVX/PacketMath.h.

◆ pset1< Packet4f >()

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::pset1< Packet4f > ( const float &  from)

Definition at line 279 of file AltiVec/PacketMath.h.

◆ pset1< Packet4i >()

template<>
EIGEN_STRONG_INLINE Packet4i Eigen::internal::pset1< Packet4i > ( const int &  from)

Definition at line 284 of file AltiVec/PacketMath.h.

◆ pset1< Packet8d >()

template<>
EIGEN_STRONG_INLINE Packet8d Eigen::internal::pset1< Packet8d > ( const double &  from)

Definition at line 121 of file AVX512/PacketMath.h.

◆ pset1< Packet8f >()

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::pset1< Packet8f > ( const float &  from)

Definition at line 120 of file AVX/PacketMath.h.

◆ pset1< Packet8i >()

template<>
EIGEN_STRONG_INLINE Packet8i Eigen::internal::pset1< Packet8i > ( const int &  from)

Definition at line 122 of file AVX/PacketMath.h.

◆ pshiftleft()

Packet8i Eigen::internal::pshiftleft ( Packet8i  v,
int  n 
)
inline

Definition at line 21 of file arch/AVX/MathFunctions.h.

◆ pshiftright()

Packet8f Eigen::internal::pshiftright ( Packet8f  v,
int  n 
)
inline

Definition at line 32 of file arch/AVX/MathFunctions.h.

◆ psin()

template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet Eigen::internal::psin ( const Packet a)

Definition at line 366 of file GenericPacketMath.h.

◆ psin< Packet4f >()

Definition at line 258 of file arch/SSE/MathFunctions.h.

◆ psin< Packet8f >()

Definition at line 49 of file arch/AVX/MathFunctions.h.

◆ psinh()

template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet Eigen::internal::psinh ( const Packet a)

Definition at line 390 of file GenericPacketMath.h.

◆ psqrt()

template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet Eigen::internal::psqrt ( const Packet a)

Definition at line 418 of file GenericPacketMath.h.

◆ psqrt< Packet2d >()

Definition at line 479 of file arch/SSE/MathFunctions.h.

◆ psqrt< Packet4d >()

Definition at line 387 of file arch/AVX/MathFunctions.h.

◆ psqrt< Packet4f >()

Definition at line 474 of file arch/SSE/MathFunctions.h.

◆ psqrt< Packet8f >()

Definition at line 382 of file arch/AVX/MathFunctions.h.

◆ pstore()

template<typename Scalar , typename Packet >
EIGEN_DEVICE_FUNC void Eigen::internal::pstore ( Scalar *  to,
const Packet from 
)
inline

Definition at line 285 of file GenericPacketMath.h.

◆ pstore1()

template<typename Packet >
void Eigen::internal::pstore1 ( typename unpacket_traits< Packet >::type *  to,
const typename unpacket_traits< Packet >::type &  a 
)
inline

Definition at line 445 of file GenericPacketMath.h.

◆ pstore1< Packet16f >()

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstore1< Packet16f > ( float *  to,
const float &  a 
)

Definition at line 606 of file AVX512/PacketMath.h.

◆ pstore1< Packet16i >()

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstore1< Packet16i > ( int *  to,
const int &  a 
)

Definition at line 616 of file AVX512/PacketMath.h.

◆ pstore1< Packet2d >()

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstore1< Packet2d > ( double *  to,
const double &  a 
)

Definition at line 406 of file SSE/PacketMath.h.

◆ pstore1< Packet4d >()

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstore1< Packet4d > ( double *  to,
const double &  a 
)

Definition at line 299 of file AVX/PacketMath.h.

◆ pstore1< Packet4f >()

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstore1< Packet4f > ( float *  to,
const float &  a 
)

Definition at line 400 of file SSE/PacketMath.h.

◆ pstore1< Packet8d >()

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstore1< Packet8d > ( double *  to,
const double &  a 
)

Definition at line 611 of file AVX512/PacketMath.h.

◆ pstore1< Packet8f >()

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstore1< Packet8f > ( float *  to,
const float &  a 
)

Definition at line 294 of file AVX/PacketMath.h.

◆ pstore1< Packet8i >()

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstore1< Packet8i > ( int *  to,
const int &  a 
)

Definition at line 304 of file AVX/PacketMath.h.

◆ pstore< double >() [1/3]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstore< double > ( double *  to,
const Packet4d from 
)

Definition at line 251 of file AVX/PacketMath.h.

◆ pstore< double >() [2/3]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstore< double > ( double *  to,
const Packet2d from 
)

Definition at line 359 of file SSE/PacketMath.h.

◆ pstore< double >() [3/3]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstore< double > ( double *  to,
const Packet8d from 
)

Definition at line 542 of file AVX512/PacketMath.h.

◆ pstore< float >() [1/3]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstore< float > ( float *  to,
const Packet8f from 
)

Definition at line 250 of file AVX/PacketMath.h.

◆ pstore< float >() [2/3]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstore< float > ( float *  to,
const Packet4f from 
)

Definition at line 259 of file AltiVec/PacketMath.h.

◆ pstore< float >() [3/3]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstore< float > ( float *  to,
const Packet16f from 
)

Definition at line 538 of file AVX512/PacketMath.h.

◆ pstore< int >() [1/3]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstore< int > ( int *  to,
const Packet8i from 
)

Definition at line 252 of file AVX/PacketMath.h.

◆ pstore< int >() [2/3]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstore< int > ( int *  to,
const Packet4i from 
)

Definition at line 269 of file AltiVec/PacketMath.h.

◆ pstore< int >() [3/3]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstore< int > ( int *  to,
const Packet16i from 
)

Definition at line 546 of file AVX512/PacketMath.h.

◆ pstore< std::complex< double > >() [1/2]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstore< std::complex< double > > ( std::complex< double > *  to,
const Packet2cd from 
)

Definition at line 310 of file AVX/Complex.h.

◆ pstore< std::complex< double > >() [2/2]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstore< std::complex< double > > ( std::complex< double > *  to,
const Packet1cd from 
)

Definition at line 340 of file SSE/Complex.h.

◆ pstore< std::complex< float > >() [1/2]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstore< std::complex< float > > ( std::complex< float > *  to,
const Packet2cf from 
)

Definition at line 80 of file AltiVec/Complex.h.

◆ pstore< std::complex< float > >() [2/2]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstore< std::complex< float > > ( std::complex< float > *  to,
const Packet4cf from 
)

Definition at line 92 of file AVX/Complex.h.

◆ pstoret()

template<typename Scalar , typename Packet , int Alignment>
EIGEN_DEVICE_FUNC EIGEN_ALWAYS_INLINE void Eigen::internal::pstoret ( Scalar *  to,
const Packet from 
)

Definition at line 471 of file GenericPacketMath.h.

◆ pstoreu()

template<typename Scalar , typename Packet >
EIGEN_DEVICE_FUNC void Eigen::internal::pstoreu ( Scalar *  to,
const Packet from 
)
inline

Definition at line 289 of file GenericPacketMath.h.

◆ pstoreu< double >() [1/3]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstoreu< double > ( double *  to,
const Packet4d from 
)

Definition at line 255 of file AVX/PacketMath.h.

◆ pstoreu< double >() [2/3]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstoreu< double > ( double *  to,
const Packet2d from 
)

Definition at line 362 of file SSE/PacketMath.h.

◆ pstoreu< double >() [3/3]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstoreu< double > ( double *  to,
const Packet8d from 
)

Definition at line 556 of file AVX512/PacketMath.h.

◆ pstoreu< float >() [1/3]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstoreu< float > ( float *  to,
const Packet8f from 
)

Definition at line 254 of file AVX/PacketMath.h.

◆ pstoreu< float >() [2/3]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstoreu< float > ( float *  to,
const Packet4f from 
)

Definition at line 509 of file AltiVec/PacketMath.h.

◆ pstoreu< float >() [3/3]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstoreu< float > ( float *  to,
const Packet16f from 
)

Definition at line 552 of file AVX512/PacketMath.h.

◆ pstoreu< int >() [1/3]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstoreu< int > ( int *  to,
const Packet8i from 
)

Definition at line 256 of file AVX/PacketMath.h.

◆ pstoreu< int >() [2/3]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstoreu< int > ( int *  to,
const Packet4i from 
)

Definition at line 504 of file AltiVec/PacketMath.h.

◆ pstoreu< int >() [3/3]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstoreu< int > ( int *  to,
const Packet16i from 
)

Definition at line 560 of file AVX512/PacketMath.h.

◆ pstoreu< std::complex< double > >() [1/2]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstoreu< std::complex< double > > ( std::complex< double > *  to,
const Packet2cd from 
)

Definition at line 311 of file AVX/Complex.h.

◆ pstoreu< std::complex< double > >() [2/2]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstoreu< std::complex< double > > ( std::complex< double > *  to,
const Packet1cd from 
)

Definition at line 341 of file SSE/Complex.h.

◆ pstoreu< std::complex< float > >() [1/2]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstoreu< std::complex< float > > ( std::complex< float > *  to,
const Packet2cf from 
)

Definition at line 81 of file AltiVec/Complex.h.

◆ pstoreu< std::complex< float > >() [2/2]

template<>
EIGEN_STRONG_INLINE void Eigen::internal::pstoreu< std::complex< float > > ( std::complex< float > *  to,
const Packet4cf from 
)

Definition at line 93 of file AVX/Complex.h.

◆ psub()

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::psub ( const Packet a,
const Packet b 
)
inline

Definition at line 156 of file GenericPacketMath.h.

◆ psub< Packet16f >()

template<>
EIGEN_STRONG_INLINE Packet16f Eigen::internal::psub< Packet16f > ( const Packet16f a,
const Packet16f b 
)

Definition at line 163 of file AVX512/PacketMath.h.

◆ psub< Packet1cd >()

template<>
EIGEN_STRONG_INLINE Packet1cd Eigen::internal::psub< Packet1cd > ( const Packet1cd a,
const Packet1cd b 
)

Definition at line 302 of file SSE/Complex.h.

◆ psub< Packet2cd >()

template<>
EIGEN_STRONG_INLINE Packet2cd Eigen::internal::psub< Packet2cd > ( const Packet2cd a,
const Packet2cd b 
)

Definition at line 273 of file AVX/Complex.h.

◆ psub< Packet2cf >()

template<>
EIGEN_STRONG_INLINE Packet2cf Eigen::internal::psub< Packet2cf > ( const Packet2cf a,
const Packet2cf b 
)

Definition at line 99 of file AltiVec/Complex.h.

◆ psub< Packet2d >()

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::psub< Packet2d > ( const Packet2d a,
const Packet2d b 
)

Definition at line 203 of file SSE/PacketMath.h.

◆ psub< Packet4cf >()

template<>
EIGEN_STRONG_INLINE Packet4cf Eigen::internal::psub< Packet4cf > ( const Packet4cf a,
const Packet4cf b 
)

Definition at line 51 of file AVX/Complex.h.

◆ psub< Packet4d >()

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::psub< Packet4d > ( const Packet4d a,
const Packet4d b 
)

Definition at line 134 of file AVX/PacketMath.h.

◆ psub< Packet4f >()

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::psub< Packet4f > ( const Packet4f a,
const Packet4f b 
)

Definition at line 352 of file AltiVec/PacketMath.h.

◆ psub< Packet4i >()

template<>
EIGEN_STRONG_INLINE Packet4i Eigen::internal::psub< Packet4i > ( const Packet4i a,
const Packet4i b 
)

Definition at line 353 of file AltiVec/PacketMath.h.

◆ psub< Packet8d >()

template<>
EIGEN_STRONG_INLINE Packet8d Eigen::internal::psub< Packet8d > ( const Packet8d a,
const Packet8d b 
)

Definition at line 168 of file AVX512/PacketMath.h.

◆ psub< Packet8f >()

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::psub< Packet8f > ( const Packet8f a,
const Packet8f b 
)

Definition at line 133 of file AVX/PacketMath.h.

◆ ptan()

template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet Eigen::internal::ptan ( const Packet a)

Definition at line 374 of file GenericPacketMath.h.

◆ ptanh()

template<typename Packet >
EIGEN_DECLARE_FUNCTION_ALLOWING_MULTIPLE_DEFINITIONS Packet Eigen::internal::ptanh ( const Packet a)

Definition at line 398 of file GenericPacketMath.h.

◆ ptanh< Packet4f >()

Definition at line 530 of file arch/SSE/MathFunctions.h.

◆ ptanh< Packet8f >()

Definition at line 271 of file arch/AVX/MathFunctions.h.

◆ ptranspose() [1/15]

EIGEN_STRONG_INLINE void Eigen::internal::ptranspose ( PacketBlock< Packet2cf, 2 > &  kernel)
inline

Definition at line 258 of file AltiVec/Complex.h.

◆ ptranspose() [2/15]

EIGEN_STRONG_INLINE void Eigen::internal::ptranspose ( PacketBlock< Packet1cd, 2 > &  kernel)

Definition at line 369 of file ZVector/Complex.h.

◆ ptranspose() [3/15]

EIGEN_DEVICE_FUNC void Eigen::internal::ptranspose ( PacketBlock< Packet4cf, 4 > &  kernel)
inline

Definition at line 435 of file AVX/Complex.h.

◆ ptranspose() [4/15]

EIGEN_DEVICE_FUNC void Eigen::internal::ptranspose ( PacketBlock< Packet2cd, 2 > &  kernel)
inline

Definition at line 453 of file AVX/Complex.h.

◆ ptranspose() [5/15]

EIGEN_DEVICE_FUNC void Eigen::internal::ptranspose ( PacketBlock< Packet8f, 8 > &  kernel)
inline

Definition at line 541 of file AVX/PacketMath.h.

◆ ptranspose() [6/15]

template<typename Packet >
EIGEN_DEVICE_FUNC void Eigen::internal::ptranspose ( PacketBlock< Packet, 1 > &  )
inline

Definition at line 544 of file GenericPacketMath.h.

◆ ptranspose() [7/15]

EIGEN_DEVICE_FUNC void Eigen::internal::ptranspose ( PacketBlock< Packet8f, 4 > &  kernel)
inline

Definition at line 569 of file AVX/PacketMath.h.

◆ ptranspose() [8/15]

EIGEN_DEVICE_FUNC void Eigen::internal::ptranspose ( PacketBlock< Packet4d, 4 > &  kernel)
inline

Definition at line 587 of file AVX/PacketMath.h.

◆ ptranspose() [9/15]

EIGEN_DEVICE_FUNC void Eigen::internal::ptranspose ( PacketBlock< Packet4f, 4 > &  kernel)
inline

Definition at line 716 of file AltiVec/PacketMath.h.

◆ ptranspose() [10/15]

EIGEN_DEVICE_FUNC void Eigen::internal::ptranspose ( PacketBlock< Packet4i, 4 > &  kernel)
inline

Definition at line 729 of file AltiVec/PacketMath.h.

◆ ptranspose() [11/15]

EIGEN_DEVICE_FUNC void Eigen::internal::ptranspose ( PacketBlock< Packet2d, 2 > &  kernel)
inline

Definition at line 771 of file SSE/PacketMath.h.

◆ ptranspose() [12/15]

EIGEN_DEVICE_FUNC void Eigen::internal::ptranspose ( PacketBlock< Packet16f, 16 > &  kernel)
inline

Definition at line 1049 of file AVX512/PacketMath.h.

◆ ptranspose() [13/15]

EIGEN_DEVICE_FUNC void Eigen::internal::ptranspose ( PacketBlock< Packet16f, 4 > &  kernel)
inline

Definition at line 1164 of file AVX512/PacketMath.h.

◆ ptranspose() [14/15]

EIGEN_DEVICE_FUNC void Eigen::internal::ptranspose ( PacketBlock< Packet8d, 4 > &  kernel)
inline

Definition at line 1207 of file AVX512/PacketMath.h.

◆ ptranspose() [15/15]

EIGEN_DEVICE_FUNC void Eigen::internal::ptranspose ( PacketBlock< Packet8d, 8 > &  kernel)
inline

Definition at line 1239 of file AVX512/PacketMath.h.

◆ punpackp()

EIGEN_STRONG_INLINE void Eigen::internal::punpackp ( Packet4f vecs)

Definition at line 494 of file SSE/PacketMath.h.

◆ pxor()

template<typename Packet >
EIGEN_DEVICE_FUNC Packet Eigen::internal::pxor ( const Packet a,
const Packet b 
)
inline

Definition at line 206 of file GenericPacketMath.h.

◆ pxor< Packet16f >()

template<>
EIGEN_STRONG_INLINE Packet16f Eigen::internal::pxor< Packet16f > ( const Packet16f a,
const Packet16f b 
)

Definition at line 343 of file AVX512/PacketMath.h.

◆ pxor< Packet1cd >()

template<>
EIGEN_STRONG_INLINE Packet1cd Eigen::internal::pxor< Packet1cd > ( const Packet1cd a,
const Packet1cd b 
)

Definition at line 326 of file SSE/Complex.h.

◆ pxor< Packet2cd >()

template<>
EIGEN_STRONG_INLINE Packet2cd Eigen::internal::pxor< Packet2cd > ( const Packet2cd a,
const Packet2cd b 
)

Definition at line 293 of file AVX/Complex.h.

◆ pxor< Packet2cf >()

template<>
EIGEN_STRONG_INLINE Packet2cf Eigen::internal::pxor< Packet2cf > ( const Packet2cf a,
const Packet2cf b 
)

Definition at line 124 of file AltiVec/Complex.h.

◆ pxor< Packet2d >()

template<>
EIGEN_STRONG_INLINE Packet2d Eigen::internal::pxor< Packet2d > ( const Packet2d a,
const Packet2d b 
)

Definition at line 299 of file SSE/PacketMath.h.

◆ pxor< Packet4cf >()

template<>
EIGEN_STRONG_INLINE Packet4cf Eigen::internal::pxor< Packet4cf > ( const Packet4cf a,
const Packet4cf b 
)

Definition at line 72 of file AVX/Complex.h.

◆ pxor< Packet4d >()

template<>
EIGEN_STRONG_INLINE Packet4d Eigen::internal::pxor< Packet4d > ( const Packet4d a,
const Packet4d b 
)

Definition at line 208 of file AVX/PacketMath.h.

◆ pxor< Packet4f >()

template<>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::pxor< Packet4f > ( const Packet4f a,
const Packet4f b 
)

Definition at line 403 of file AltiVec/PacketMath.h.

◆ pxor< Packet4i >()

template<>
EIGEN_STRONG_INLINE Packet4i Eigen::internal::pxor< Packet4i > ( const Packet4i a,
const Packet4i b 
)

Definition at line 404 of file AltiVec/PacketMath.h.

◆ pxor< Packet8d >()

template<>
EIGEN_STRONG_INLINE Packet8d Eigen::internal::pxor< Packet8d > ( const Packet8d a,
const Packet8d b 
)

Definition at line 369 of file AVX512/PacketMath.h.

◆ pxor< Packet8f >()

template<>
EIGEN_STRONG_INLINE Packet8f Eigen::internal::pxor< Packet8f > ( const Packet8f a,
const Packet8f b 
)

Definition at line 207 of file AVX/PacketMath.h.

◆ queryCacheSizes()

void Eigen::internal::queryCacheSizes ( int &  l1,
int &  l2,
int &  l3 
)
inline

Definition at line 920 of file Memory.h.

◆ queryL1CacheSize()

int Eigen::internal::queryL1CacheSize ( )
inline

Definition at line 957 of file Memory.h.

◆ queryTopLevelCacheSize()

int Eigen::internal::queryTopLevelCacheSize ( )
inline

Definition at line 966 of file Memory.h.

◆ QuickSplit()

template<typename VectorV , typename VectorI >
Index Eigen::internal::QuickSplit ( VectorV &  row,
VectorI &  ind,
Index  ncut 
)

Definition at line 29 of file IncompleteLUT.h.

◆ rcond_estimate_helper()

template<typename Decomposition >
Decomposition::RealScalar Eigen::internal::rcond_estimate_helper ( typename Decomposition::RealScalar  matrix_norm,
const Decomposition &  dec 
)

Reciprocal condition number estimator.

Computing a decomposition of a dense matrix takes O(n^3) operations, while this method estimates the condition number quickly and reliably in O(n^2) operations.

Returns
an estimate of the reciprocal condition number (1 / (||matrix||_1 * ||inv(matrix)||_1)) of matrix, given ||matrix||_1 and its decomposition. Supports the following decompositions: FullPivLU, PartialPivLU, LDLT, and LLT.
See also
FullPivLU, PartialPivLU, LDLT, LLT.

Definition at line 159 of file ConditionEstimator.h.

◆ rcond_invmatrix_L1_norm_estimate()

template<typename Decomposition >
Decomposition::RealScalar Eigen::internal::rcond_invmatrix_L1_norm_estimate ( const Decomposition &  dec)
Returns
an estimate of ||inv(matrix)||_1 given a decomposition of matrix that implements .solve() and .adjoint().solve() methods.

This function implements Algorithms 4.1 and 5.1 from http://www.maths.manchester.ac.uk/~higham/narep/narep135.pdf which also forms the basis for the condition number estimators in LAPACK. Since at most 10 calls to the solve method of dec are performed, the total cost is O(dims^2), as opposed to O(dims^3) needed to compute the inverse matrix explicitly.

The most common usage is in estimating the condition number ||matrix||_1 * ||inv(matrix)||_1. The first term ||matrix||_1 can be computed directly in O(n^2) operations.

Supports the following decompositions: FullPivLU, PartialPivLU, LDLT, and LLT.

See also
FullPivLU, PartialPivLU, LDLT, LLT.

Definition at line 56 of file ConditionEstimator.h.

◆ real_2x2_jacobi_svd()

template<typename MatrixType , typename RealScalar , typename Index >
void Eigen::internal::real_2x2_jacobi_svd ( const MatrixType &  matrix,
Index  p,
Index  q,
JacobiRotation< RealScalar > *  j_left,
JacobiRotation< RealScalar > *  j_right 
)

Definition at line 19 of file RealSvd2x2.h.

◆ return_ptr()

template<typename T >
const T* Eigen::internal::return_ptr ( )

◆ set_from_triplets()

template<typename InputIterator , typename SparseMatrixType , typename DupFunctor >
void Eigen::internal::set_from_triplets ( const InputIterator &  begin,
const InputIterator &  end,
SparseMatrixType &  mat,
DupFunctor  dup_func 
)

Definition at line 916 of file SparseMatrix.h.

◆ smart_copy()

template<typename T >
EIGEN_DEVICE_FUNC void Eigen::internal::smart_copy ( const T *  start,
const T *  end,
T *  target 
)

Definition at line 485 of file Memory.h.

◆ smart_memmove()

template<typename T >
void Eigen::internal::smart_memmove ( const T *  start,
const T *  end,
T *  target 
)

Definition at line 508 of file Memory.h.

◆ solve_sparse_through_dense_panels() [1/2]

template<typename Decomposition , typename Rhs , typename Dest >
enable_if<Rhs::ColsAtCompileTime!=1 && Dest::ColsAtCompileTime!=1>::type Eigen::internal::solve_sparse_through_dense_panels ( const Decomposition &  dec,
const Rhs &  rhs,
Dest &  dest 
)

Definition at line 23 of file SparseSolverBase.h.

◆ solve_sparse_through_dense_panels() [2/2]

template<typename Decomposition , typename Rhs , typename Dest >
enable_if<Rhs::ColsAtCompileTime==1 || Dest::ColsAtCompileTime==1>::type Eigen::internal::solve_sparse_through_dense_panels ( const Decomposition &  dec,
const Rhs &  rhs,
Dest &  dest 
)

Definition at line 47 of file SparseSolverBase.h.

◆ sparse_selfadjoint_time_dense_product()

template<int Mode, typename SparseLhsType , typename DenseRhsType , typename DenseResType , typename AlphaType >
void Eigen::internal::sparse_selfadjoint_time_dense_product ( const SparseLhsType &  lhs,
const DenseRhsType &  rhs,
DenseResType &  res,
const AlphaType &  alpha 
)
inline

Definition at line 250 of file SparseSelfAdjointView.h.

◆ sparse_sparse_product_with_pruning_impl()

template<typename Lhs , typename Rhs , typename ResultType >
static void Eigen::internal::sparse_sparse_product_with_pruning_impl ( const Lhs &  lhs,
const Rhs &  rhs,
ResultType &  res,
const typename ResultType::RealScalar &  tolerance 
)
static

Definition at line 20 of file SparseSparseProductWithPruning.h.

◆ sparse_sparse_to_dense_product_impl()

template<typename Lhs , typename Rhs , typename ResultType >
static void Eigen::internal::sparse_sparse_to_dense_product_impl ( const Lhs &  lhs,
const Rhs &  rhs,
ResultType &  res 
)
static

Definition at line 264 of file ConservativeSparseSparseProduct.h.

◆ sparse_time_dense_product()

template<typename SparseLhsType , typename DenseRhsType , typename DenseResType , typename AlphaType >
void Eigen::internal::sparse_time_dense_product ( const SparseLhsType &  lhs,
const DenseRhsType &  rhs,
DenseResType &  res,
const AlphaType &  alpha 
)
inline

Definition at line 147 of file SparseDenseProduct.h.

◆ sparselu_gemm()

template<typename Scalar >
EIGEN_DONT_INLINE void Eigen::internal::sparselu_gemm ( Index  m,
Index  n,
Index  d,
const Scalar *  A,
Index  lda,
const Scalar *  B,
Index  ldb,
Scalar *  C,
Index  ldc 
)

Definition at line 26 of file SparseLU_gemm_kernel.h.

◆ stable_norm_kernel()

template<typename ExpressionType , typename Scalar >
void Eigen::internal::stable_norm_kernel ( const ExpressionType &  bl,
Scalar &  ssq,
Scalar &  scale,
Scalar &  invScale 
)
inline

Definition at line 18 of file StableNorm.h.

◆ swap()

template<typename T >
void Eigen::internal::swap ( scoped_array< T > &  a,
scoped_array< T > &  b 
)

Definition at line 602 of file Memory.h.

◆ throw_std_bad_alloc()

EIGEN_DEVICE_FUNC void Eigen::internal::throw_std_bad_alloc ( )
inline

Definition at line 67 of file Memory.h.

◆ toRotationMatrix() [1/3]

template<typename Scalar , int Dim>
static EIGEN_DEVICE_FUNC Matrix<Scalar,2,2> Eigen::internal::toRotationMatrix ( const Scalar &  s)
inlinestatic

Definition at line 182 of file RotationBase.h.

◆ toRotationMatrix() [2/3]

template<typename Scalar , int Dim, typename OtherDerived >
static EIGEN_DEVICE_FUNC Matrix<Scalar,Dim,Dim> Eigen::internal::toRotationMatrix ( const RotationBase< OtherDerived, Dim > &  r)
inlinestatic

Definition at line 189 of file RotationBase.h.

◆ toRotationMatrix() [3/3]

template<typename Scalar , int Dim, typename OtherDerived >
static EIGEN_DEVICE_FUNC const MatrixBase<OtherDerived>& Eigen::internal::toRotationMatrix ( const MatrixBase< OtherDerived > &  mat)
inlinestatic

Definition at line 195 of file RotationBase.h.

◆ treePostorder()

template<typename IndexVector >
void Eigen::internal::treePostorder ( typename IndexVector::Scalar  n,
IndexVector &  parent,
IndexVector &  post 
)

Post order a tree.

Parameters
nthe number of nodes
parentInput tree
postpostordered tree

Definition at line 178 of file SparseColEtree.h.

◆ tridiagonal_qr_step()

template<int StorageOrder, typename RealScalar , typename Scalar , typename Index >
static EIGEN_DEVICE_FUNC void Eigen::internal::tridiagonal_qr_step ( RealScalar *  diag,
RealScalar *  subdiag,
Index  start,
Index  end,
Scalar *  matrixQ,
Index  n 
)
static

Definition at line 807 of file SelfAdjointEigenSolver.h.

◆ tridiagonalization_inplace() [1/2]

template<typename MatrixType , typename CoeffVectorType >
void Eigen::internal::tridiagonalization_inplace ( MatrixType &  matA,
CoeffVectorType &  hCoeffs 
)

Definition at line 347 of file Tridiagonalization.h.

◆ tridiagonalization_inplace() [2/2]

template<typename MatrixType , typename DiagonalType , typename SubDiagonalType >
void Eigen::internal::tridiagonalization_inplace ( MatrixType &  mat,
DiagonalType &  diag,
SubDiagonalType &  subdiag,
bool  extractQ 
)

Performs a full tridiagonalization in place.

Parameters
[in,out]matOn input, the selfadjoint matrix whose tridiagonal decomposition is to be computed. Only the lower triangular part referenced. The rest is left unchanged. On output, the orthogonal matrix Q in the decomposition if extractQ is true.
[out]diagThe diagonal of the tridiagonal matrix T in the decomposition.
[out]subdiagThe subdiagonal of the tridiagonal matrix T in the decomposition.
[in]extractQIf true, the orthogonal matrix Q in the decomposition is computed and stored in mat.

Computes the tridiagonal decomposition of the selfadjoint matrix mat in place such that $ mat = Q T Q^* $ where $ Q $ is unitary and $ T $ a real symmetric tridiagonal matrix.

The tridiagonal matrix T is passed to the output parameters diag and subdiag. If extractQ is true, then the orthogonal matrix Q is passed to mat. Otherwise the lower part of the matrix mat is destroyed.

The vectors diag and subdiag are not resized. The function assumes that they are already of the correct size. The length of the vector diag should equal the number of rows in mat, and the length of the vector subdiag should be one left.

This implementation contains an optimized path for 3-by-3 matrices which is especially useful for plane fitting.

Note
Currently, it requires two temporary vectors to hold the intermediate Householder coefficients, and to reconstruct the matrix Q from the Householder reflectors.

Example (this uses the same matrix as the example in Tridiagonalization::Tridiagonalization(const MatrixType&)):

Output:

See also
class Tridiagonalization

Definition at line 427 of file Tridiagonalization.h.

◆ upperbidiagonalization_blocked_helper()

template<typename MatrixType >
void Eigen::internal::upperbidiagonalization_blocked_helper ( MatrixType &  A,
typename MatrixType::RealScalar *  diagonal,
typename MatrixType::RealScalar *  upper_diagonal,
Index  bs,
Ref< Matrix< typename MatrixType::Scalar, Dynamic, Dynamic, traits< MatrixType >::Flags &RowMajorBit > >  X,
Ref< Matrix< typename MatrixType::Scalar, Dynamic, Dynamic, traits< MatrixType >::Flags &RowMajorBit > >  Y 
)

Definition at line 152 of file UpperBidiagonalization.h.

◆ upperbidiagonalization_inplace_blocked()

template<typename MatrixType , typename BidiagType >
void Eigen::internal::upperbidiagonalization_inplace_blocked ( MatrixType &  A,
BidiagType &  bidiagonal,
Index  maxBlockSize = 32,
typename MatrixType::Scalar *  = 0 
)

Definition at line 282 of file UpperBidiagonalization.h.

◆ upperbidiagonalization_inplace_unblocked()

template<typename MatrixType >
void Eigen::internal::upperbidiagonalization_inplace_unblocked ( MatrixType &  mat,
typename MatrixType::RealScalar *  diagonal,
typename MatrixType::RealScalar *  upper_diagonal,
typename MatrixType::Scalar *  tempData = 0 
)

Definition at line 93 of file UpperBidiagonalization.h.

◆ useSpecificBlockingSizes()

template<typename Index >
bool Eigen::internal::useSpecificBlockingSizes ( Index k,
Index m,
Index n 
)
inline

Definition at line 263 of file GeneralBlockPanelKernel.h.

◆ vec_splat_packet4f()

template<int element>
EIGEN_STRONG_INLINE Packet4f Eigen::internal::vec_splat_packet4f ( const Packet4f from)

Definition at line 263 of file ZVector/PacketMath.h.

Variable Documentation

◆ defaultL1CacheSize

const std::ptrdiff_t Eigen::internal::defaultL1CacheSize = 16*1024

Definition at line 33 of file GeneralBlockPanelKernel.h.

◆ defaultL2CacheSize

const std::ptrdiff_t Eigen::internal::defaultL2CacheSize = 512*1024

Definition at line 34 of file GeneralBlockPanelKernel.h.

◆ defaultL3CacheSize

const std::ptrdiff_t Eigen::internal::defaultL3CacheSize = 512*1024

Definition at line 35 of file GeneralBlockPanelKernel.h.

◆ p16uc_COMPLEX32_REV

Packet16uc Eigen::internal::p16uc_COMPLEX32_REV = vec_sld(p16uc_REVERSE32, p16uc_REVERSE32, 8)
static

Definition at line 118 of file AltiVec/PacketMath.h.

◆ p16uc_COMPLEX32_REV2

Packet16uc Eigen::internal::p16uc_COMPLEX32_REV2 = vec_sld(p16uc_PSET64_HI, p16uc_PSET64_LO, 8)
static

Definition at line 123 of file AltiVec/PacketMath.h.

◆ p16uc_DUPLICATE32_HI [1/2]

Packet16uc Eigen::internal::p16uc_DUPLICATE32_HI = { 0,1,2,3, 0,1,2,3, 4,5,6,7, 4,5,6,7 }
static

Definition at line 84 of file AltiVec/PacketMath.h.

◆ p16uc_DUPLICATE32_HI [2/2]

Packet16uc Eigen::internal::p16uc_DUPLICATE32_HI = { 0,1,2,3, 0,1,2,3, 4,5,6,7, 4,5,6,7 }
static

Definition at line 98 of file ZVector/PacketMath.h.

◆ p16uc_FORWARD [1/2]

Packet16uc Eigen::internal::p16uc_FORWARD = p16uc_REVERSE32
static

Definition at line 106 of file AltiVec/PacketMath.h.

◆ p16uc_FORWARD [2/2]

Packet16uc Eigen::internal::p16uc_FORWARD = { 0,1,2,3, 4,5,6,7, 8,9,10,11, 12,13,14,15 }
static

Definition at line 108 of file ZVector/PacketMath.h.

◆ p16uc_HALF64_0_16

Packet16uc Eigen::internal::p16uc_HALF64_0_16 = vec_sld(vec_splat((Packet16uc) vec_abs(p4i_MINUS16), 0), (Packet16uc)p4i_ZERO, 8)
static

Definition at line 110 of file AltiVec/PacketMath.h.

◆ p16uc_PSET32_WEVEN [1/2]

Packet16uc Eigen::internal::p16uc_PSET32_WEVEN = vec_sld((Packet16uc) vec_splat((Packet4ui)p16uc_FORWARD, 0), (Packet16uc) vec_splat((Packet4ui)p16uc_FORWARD, 2), 8)
static

Definition at line 109 of file AltiVec/PacketMath.h.

◆ p16uc_PSET32_WEVEN [2/2]

Packet16uc Eigen::internal::p16uc_PSET32_WEVEN = vec_sld(p16uc_DUPLICATE32_HI, (Packet16uc) vec_splat((Packet4ui)p16uc_FORWARD, 3), 8)
static

Definition at line 113 of file ZVector/PacketMath.h.

◆ p16uc_PSET32_WODD [1/2]

Packet16uc Eigen::internal::p16uc_PSET32_WODD = vec_sld((Packet16uc) vec_splat((Packet4ui)p16uc_FORWARD, 1), (Packet16uc) vec_splat((Packet4ui)p16uc_FORWARD, 3), 8)
static

Definition at line 108 of file AltiVec/PacketMath.h.

◆ p16uc_PSET32_WODD [2/2]

Packet16uc Eigen::internal::p16uc_PSET32_WODD = vec_sld((Packet16uc) vec_splat((Packet4ui)p16uc_FORWARD, 0), (Packet16uc) vec_splat((Packet4ui)p16uc_FORWARD, 2), 8)
static

Definition at line 112 of file ZVector/PacketMath.h.

◆ p16uc_PSET64_HI [1/2]

Packet16uc Eigen::internal::p16uc_PSET64_HI = { 0,1,2,3, 4,5,6,7, 0,1,2,3, 4,5,6,7 }
static

Definition at line 97 of file ZVector/PacketMath.h.

◆ p16uc_PSET64_HI [2/2]

Packet16uc Eigen::internal::p16uc_PSET64_HI = (Packet16uc) vec_mergeh((Packet4ui)p16uc_PSET32_WODD, (Packet4ui)p16uc_PSET32_WEVEN)
static

Definition at line 113 of file AltiVec/PacketMath.h.

◆ p16uc_PSET64_LO [1/2]

Packet16uc Eigen::internal::p16uc_PSET64_LO = (Packet16uc) vec_mergel((Packet4ui)p16uc_PSET32_WODD, (Packet4ui)p16uc_PSET32_WEVEN)
static

Definition at line 114 of file AltiVec/PacketMath.h.

◆ p16uc_PSET64_LO [2/2]

Packet16uc Eigen::internal::p16uc_PSET64_LO = (Packet16uc) vec_mergel((Packet4ui)p16uc_PSET32_WODD, (Packet4ui)p16uc_PSET32_WEVEN)
static

Definition at line 117 of file ZVector/PacketMath.h.

◆ p16uc_REVERSE32 [1/2]

Packet16uc Eigen::internal::p16uc_REVERSE32 = { 12,13,14,15, 8,9,10,11, 4,5,6,7, 0,1,2,3 }
static

Definition at line 83 of file AltiVec/PacketMath.h.

◆ p16uc_REVERSE32 [2/2]

Packet16uc Eigen::internal::p16uc_REVERSE32 = { 12,13,14,15, 8,9,10,11, 4,5,6,7, 0,1,2,3 }
static

Definition at line 109 of file ZVector/PacketMath.h.

◆ p16uc_REVERSE64 [1/2]

Packet16uc Eigen::internal::p16uc_REVERSE64 = { 8,9,10,11, 12,13,14,15, 0,1,2,3, 4,5,6,7 }
static

Definition at line 107 of file AltiVec/PacketMath.h.

◆ p16uc_REVERSE64 [2/2]

Packet16uc Eigen::internal::p16uc_REVERSE64 = { 8,9,10,11, 12,13,14,15, 0,1,2,3, 4,5,6,7 }
static

Definition at line 110 of file ZVector/PacketMath.h.

◆ p16uc_TRANSPOSE64_HI [1/2]

Packet16uc Eigen::internal::p16uc_TRANSPOSE64_HI = p16uc_PSET64_HI + p16uc_HALF64_0_16
static

Definition at line 115 of file AltiVec/PacketMath.h.

◆ p16uc_TRANSPOSE64_HI [2/2]

Packet16uc Eigen::internal::p16uc_TRANSPOSE64_HI = { 0,1,2,3, 4,5,6,7, 16,17,18,19, 20,21,22,23}
static

Definition at line 120 of file ZVector/PacketMath.h.

◆ p16uc_TRANSPOSE64_LO [1/2]

Packet16uc Eigen::internal::p16uc_TRANSPOSE64_LO = p16uc_PSET64_LO + p16uc_HALF64_0_16
static

Definition at line 116 of file AltiVec/PacketMath.h.

◆ p16uc_TRANSPOSE64_LO [2/2]

Packet16uc Eigen::internal::p16uc_TRANSPOSE64_LO = { 8,9,10,11, 12,13,14,15, 24,25,26,27, 28,29,30,31}
static

Definition at line 121 of file ZVector/PacketMath.h.

◆ p2d_COUNTDOWN

Packet2d Eigen::internal::p2d_COUNTDOWN = reinterpret_cast<Packet2d>(vec_sld(reinterpret_cast<Packet16uc>(p2d_ZERO), reinterpret_cast<Packet16uc>(p2d_ONE), 8))
static

Definition at line 95 of file ZVector/PacketMath.h.

◆ p2d_ONE

Packet2d Eigen::internal::p2d_ONE = { 1.0, 1.0 }
static

Definition at line 90 of file ZVector/PacketMath.h.

◆ p2d_ZERO_

Packet2d Eigen::internal::p2d_ZERO_ = { -0.0, -0.0 }
static

Definition at line 91 of file ZVector/PacketMath.h.

◆ p2ul_CONJ_XOR1

Packet2ul Eigen::internal::p2ul_CONJ_XOR1 = (Packet2ul) vec_sld((Packet4ui) p2d_ZERO_, (Packet4ui) p2l_ZERO, 8)
static

Definition at line 18 of file ZVector/Complex.h.

◆ p2ul_CONJ_XOR2

Packet2ul Eigen::internal::p2ul_CONJ_XOR2 = (Packet2ul) vec_sld((Packet4ui) p2l_ZERO, (Packet4ui) p2d_ZERO_, 8)
static

Definition at line 19 of file ZVector/Complex.h.

◆ p4f_COUNTDOWN [1/2]

Packet4f Eigen::internal::p4f_COUNTDOWN = { 0.0, 1.0, 2.0, 3.0 }
static

Definition at line 80 of file AltiVec/PacketMath.h.

◆ p4f_COUNTDOWN [2/2]

Packet4f Eigen::internal::p4f_COUNTDOWN = { 0.0, 1.0, 2.0, 3.0 }
static

Definition at line 94 of file ZVector/PacketMath.h.

◆ p4f_ONE

Packet4f Eigen::internal::p4f_ONE = vec_ctf(p4i_ONE, 0)
static

Definition at line 77 of file AltiVec/PacketMath.h.

◆ p4f_ZERO_

Packet4f Eigen::internal::p4f_ZERO_ = (Packet4f) vec_sl((Packet4ui)p4i_MINUS1, (Packet4ui)p4i_MINUS1)
static

Definition at line 75 of file AltiVec/PacketMath.h.

◆ p4i_COUNTDOWN [1/2]

Packet4i Eigen::internal::p4i_COUNTDOWN = { 0, 1, 2, 3 }
static

Definition at line 81 of file AltiVec/PacketMath.h.

◆ p4i_COUNTDOWN [2/2]

Packet4i Eigen::internal::p4i_COUNTDOWN = { 0, 1, 2, 3 }
static

Definition at line 93 of file ZVector/PacketMath.h.

◆ p4ui_CONJ_XOR

Packet4ui Eigen::internal::p4ui_CONJ_XOR = vec_mergeh((Packet4ui)p4i_ZERO, (Packet4ui)p4f_ZERO_)
static

Definition at line 18 of file AltiVec/Complex.h.



co_scan
Author(s):
autogenerated on Mon Feb 28 2022 23:01:04