|  | 
| typedef MatrixBase< DiagonalProduct > | Base | 
|  | 
| enum |  | 
|  | 
| typedef internal::conditional< NumTraits< Scalar >::IsComplex, CwiseUnaryOp< internal::scalar_conjugate_op< Scalar >, ConstTransposeReturnType >, ConstTransposeReturnType >::type | AdjointReturnType | 
|  | 
| typedef DenseBase< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | Base | 
|  | 
| typedef Block< const CwiseNullaryOp< internal::scalar_identity_op< Scalar >, SquareMatrixType >, internal::traits< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >::RowsAtCompileTime, internal::traits< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >::ColsAtCompileTime > | BasisReturnType | 
|  | 
| typedef Base::CoeffReturnType | CoeffReturnType | 
|  | 
| typedef Base::ColXpr | ColXpr | 
|  | 
| typedef internal::conditional< NumTraits< Scalar >::IsComplex, const CwiseUnaryOp< internal::scalar_conjugate_op< Scalar >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder > & >::type | ConjugateReturnType | 
|  | 
| typedef CwiseNullaryOp< internal::scalar_constant_op< Scalar >, DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | ConstantReturnType | 
|  | 
| typedef internal::add_const< Diagonal< const DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > >::type | ConstDiagonalReturnType | 
|  | 
| typedef Block< const DiagonalProduct< MatrixType, DiagonalType, ProductOrder >, internal::traits< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >::ColsAtCompileTime==1?SizeMinusOne:1, internal::traits< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >::ColsAtCompileTime==1?1:SizeMinusOne > | ConstStartMinusOne | 
|  | 
| typedef Base::ConstTransposeReturnType | ConstTransposeReturnType | 
|  | 
| typedef Diagonal< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | DiagonalReturnType | 
|  | 
| typedef Matrix< std::complex< RealScalar >, internal::traits< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >::ColsAtCompileTime, 1, ColMajor > | EigenvaluesReturnType | 
|  | 
| typedef CwiseUnaryOp< internal::scalar_quotient1_op< typename internal::traits< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >::Scalar >, const ConstStartMinusOne > | HNormalizedReturnType | 
|  | 
| typedef CwiseNullaryOp< internal::scalar_identity_op< Scalar >, DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | IdentityReturnType | 
|  | 
| typedef CwiseUnaryOp< internal::scalar_imag_op< Scalar >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | ImagReturnType | 
|  | 
| typedef internal::traits< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >::Index | Index | 
|  | 
| typedef CwiseUnaryView< internal::scalar_imag_ref_op< Scalar >, DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | NonConstImagReturnType | 
|  | 
| typedef internal::conditional< NumTraits< Scalar >::IsComplex, CwiseUnaryView< internal::scalar_real_ref_op< Scalar >, DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >, DiagonalProduct< MatrixType, DiagonalType, ProductOrder > & >::type | NonConstRealReturnType | 
|  | 
| typedef internal::packet_traits< Scalar >::type | PacketScalar | 
|  | 
| typedef Matrix< typename internal::traits< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >::Scalar, internal::traits< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >::RowsAtCompileTime, internal::traits< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >::ColsAtCompileTime, AutoAlign|(internal::traits< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >::Flags &RowMajorBit?RowMajor:ColMajor), internal::traits< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >::MaxRowsAtCompileTime, internal::traits< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >::MaxColsAtCompileTime > | PlainObject | 
|  | The plain matrix type corresponding to this expression.  More... 
 | 
|  | 
| typedef internal::conditional< NumTraits< Scalar >::IsComplex, const CwiseUnaryOp< internal::scalar_real_op< Scalar >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder > & >::type | RealReturnType | 
|  | 
| typedef NumTraits< Scalar >::Real | RealScalar | 
|  | 
| typedef Base::RowXpr | RowXpr | 
|  | 
| typedef internal::traits< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >::Scalar | Scalar | 
|  | 
| typedef CwiseUnaryOp< internal::scalar_multiple_op< Scalar >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | ScalarMultipleReturnType | 
|  | 
| typedef CwiseUnaryOp< internal::scalar_quotient1_op< Scalar >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | ScalarQuotient1ReturnType | 
|  | 
| typedef Matrix< Scalar, EIGEN_SIZE_MAX(RowsAtCompileTime, ColsAtCompileTime), EIGEN_SIZE_MAX(RowsAtCompileTime, ColsAtCompileTime)> | SquareMatrixType | 
|  | 
| typedef internal::stem_function< Scalar >::type | StemFunction | 
|  | 
| typedef MatrixBase | StorageBaseType | 
|  | 
| typedef internal::traits< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >::StorageKind | StorageKind | 
|  | 
| enum | { RowsAtCompileTime = internal::traits<Derived>::RowsAtCompileTime, 
ColsAtCompileTime = internal::traits<Derived>::ColsAtCompileTime, 
SizeAtCompileTime, 
MaxRowsAtCompileTime = internal::traits<Derived>::MaxRowsAtCompileTime,
 MaxColsAtCompileTime = internal::traits<Derived>::MaxColsAtCompileTime, 
MaxSizeAtCompileTime, 
IsVectorAtCompileTime, 
Flags = internal::traits<Derived>::Flags,
 IsRowMajor = int(Flags) & RowMajorBit, 
InnerSizeAtCompileTime, 
CoeffReadCost = internal::traits<Derived>::CoeffReadCost, 
InnerStrideAtCompileTime = internal::inner_stride_at_compile_time<Derived>::ret,
 OuterStrideAtCompileTime = internal::outer_stride_at_compile_time<Derived>::ret
 }
 | 
|  | 
| enum | { ThisConstantIsPrivateInPlainObjectBase
 } | 
|  | 
| typedef DenseCoeffsBase< Derived > | Base | 
|  | 
| typedef Base::CoeffReturnType | CoeffReturnType | 
|  | 
| typedef Block< Derived, internal::traits< Derived >::RowsAtCompileTime, Dynamic,!IsRowMajor > | ColsBlockXpr | 
|  | 
| typedef VectorwiseOp< Derived, Vertical > | ColwiseReturnType | 
|  | 
| typedef Block< Derived, internal::traits< Derived >::RowsAtCompileTime, 1,!IsRowMajor > | ColXpr | 
|  | 
| typedef CwiseNullaryOp< internal::scalar_constant_op< Scalar >, Derived > | ConstantReturnType | 
|  | 
| typedef const Block< const Derived, internal::traits< Derived >::RowsAtCompileTime, Dynamic,!IsRowMajor > | ConstColsBlockXpr | 
|  | 
| typedef const VectorwiseOp< const Derived, Vertical > | ConstColwiseReturnType | 
|  | 
| typedef const Block< const Derived, internal::traits< Derived >::RowsAtCompileTime, 1,!IsRowMajor > | ConstColXpr | 
|  | 
| typedef const Reverse< const Derived, BothDirections > | ConstReverseReturnType | 
|  | 
| typedef const Block< const Derived, Dynamic, internal::traits< Derived >::ColsAtCompileTime, IsRowMajor > | ConstRowsBlockXpr | 
|  | 
| typedef const VectorwiseOp< const Derived, Horizontal > | ConstRowwiseReturnType | 
|  | 
| typedef const Block< const Derived, 1, internal::traits< Derived >::ColsAtCompileTime, IsRowMajor > | ConstRowXpr | 
|  | 
| typedef const VectorBlock< const Derived > | ConstSegmentReturnType | 
|  | 
| typedef internal::add_const< Transpose< const Derived > >::type | ConstTransposeReturnType | 
|  | 
| typedef Matrix< typename NumTraits< typename internal::traits< Derived >::Scalar >::Real, internal::traits< Derived >::ColsAtCompileTime, 1 > | EigenvaluesReturnType | 
|  | 
| typedef internal::add_const_on_value_type< typename internal::eval< Derived >::type >::type | EvalReturnType | 
|  | 
| typedef internal::traits< Derived >::Index | Index | 
|  | The type of indices.  More... 
 | 
|  | 
| typedef internal::packet_traits< Scalar >::type | PacketScalar | 
|  | 
| typedef CwiseNullaryOp< internal::linspaced_op< Scalar, true >, Derived > | RandomAccessLinSpacedReturnType | 
|  | 
| typedef NumTraits< Scalar >::Real | RealScalar | 
|  | 
| typedef Reverse< Derived, BothDirections > | ReverseReturnType | 
|  | 
| typedef Block< Derived, Dynamic, internal::traits< Derived >::ColsAtCompileTime, IsRowMajor > | RowsBlockXpr | 
|  | 
| typedef VectorwiseOp< Derived, Horizontal > | RowwiseReturnType | 
|  | 
| typedef Block< Derived, 1, internal::traits< Derived >::ColsAtCompileTime, IsRowMajor > | RowXpr | 
|  | 
| typedef internal::traits< Derived >::Scalar | Scalar | 
|  | 
| typedef VectorBlock< Derived > | SegmentReturnType | 
|  | 
| typedef CwiseNullaryOp< internal::linspaced_op< Scalar, false >, Derived > | SequentialLinSpacedReturnType | 
|  | 
| typedef internal::traits< Derived >::StorageKind | StorageKind | 
|  | 
|  | 
| EIGEN_STRONG_INLINE const Scalar | coeff (Index row, Index col) const | 
|  | 
| EIGEN_STRONG_INLINE const Scalar | coeff (Index idx) const | 
|  | 
| EIGEN_STRONG_INLINE Index | cols () const | 
|  | 
|  | DiagonalProduct (const MatrixType &matrix, const DiagonalType &diagonal) | 
|  | 
| template<int LoadMode> | 
| EIGEN_STRONG_INLINE PacketScalar | packet (Index row, Index col) const | 
|  | 
| template<int LoadMode> | 
| EIGEN_STRONG_INLINE PacketScalar | packet (Index idx) const | 
|  | 
| EIGEN_STRONG_INLINE Index | rows () const | 
|  | 
| const AdjointReturnType | adjoint () const | 
|  | 
| void | adjointInPlace () | 
|  | 
| void | applyHouseholderOnTheLeft (const EssentialPart &essential, const Scalar &tau, Scalar *workspace) | 
|  | 
| void | applyHouseholderOnTheRight (const EssentialPart &essential, const Scalar &tau, Scalar *workspace) | 
|  | 
| void | applyOnTheLeft (const EigenBase< OtherDerived > &other) | 
|  | 
| void | applyOnTheLeft (Index p, Index q, const JacobiRotation< OtherScalar > &j) | 
|  | 
| void | applyOnTheRight (const EigenBase< OtherDerived > &other) | 
|  | 
| void | applyOnTheRight (Index p, Index q, const JacobiRotation< OtherScalar > &j) | 
|  | 
| ArrayWrapper< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | array () | 
|  | 
| const ArrayWrapper< const DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | array () const | 
|  | 
| const DiagonalWrapper< const DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | asDiagonal () const | 
|  | 
| const PermutationWrapper< const DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | asPermutation () const | 
|  | 
| EIGEN_STRONG_INLINE const CwiseBinaryOp< CustomBinaryOp, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder >, const OtherDerived > | binaryExpr (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other, const CustomBinaryOp &func=CustomBinaryOp()) const | 
|  | 
| RealScalar | blueNorm () const | 
|  | 
| internal::cast_return_type< DiagonalProduct< MatrixType, DiagonalType, ProductOrder >, const CwiseUnaryOp< internal::scalar_cast_op< typename internal::traits< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >::Scalar, NewType >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > >::type | cast () const | 
|  | 
| const ColPivHouseholderQR< PlainObject > | colPivHouseholderQr () const | 
|  | 
| void | computeInverseAndDetWithCheck (ResultType &inverse, typename ResultType::Scalar &determinant, bool &invertible, const RealScalar &absDeterminantThreshold=NumTraits< Scalar >::dummy_precision()) const | 
|  | 
| void | computeInverseWithCheck (ResultType &inverse, bool &invertible, const RealScalar &absDeterminantThreshold=NumTraits< Scalar >::dummy_precision()) const | 
|  | 
| ConjugateReturnType | conjugate () const | 
|  | 
| const MatrixFunctionReturnValue< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | cos () const | 
|  | 
| const MatrixFunctionReturnValue< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | cosh () const | 
|  | 
| cross_product_return_type< OtherDerived >::type | cross (const MatrixBase< OtherDerived > &other) const | 
|  | 
| PlainObject | cross3 (const MatrixBase< OtherDerived > &other) const | 
|  | 
| EIGEN_STRONG_INLINE const CwiseUnaryOp< internal::scalar_abs_op< Scalar >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | cwiseAbs () const | 
|  | 
| EIGEN_STRONG_INLINE const CwiseUnaryOp< internal::scalar_abs2_op< Scalar >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | cwiseAbs2 () const | 
|  | 
| const CwiseBinaryOp< std::equal_to< Scalar >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder >, const OtherDerived > | cwiseEqual (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const | 
|  | 
| const CwiseUnaryOp< std::binder1st< std::equal_to< Scalar > >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | cwiseEqual (const Scalar &s) const | 
|  | 
| const CwiseUnaryOp< internal::scalar_inverse_op< Scalar >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | cwiseInverse () const | 
|  | 
| EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_max_op< Scalar >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder >, const OtherDerived > | cwiseMax (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const | 
|  | 
| EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_max_op< Scalar >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder >, const ConstantReturnType > | cwiseMax (const Scalar &other) const | 
|  | 
| EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_min_op< Scalar >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder >, const OtherDerived > | cwiseMin (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const | 
|  | 
| EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_min_op< Scalar >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder >, const ConstantReturnType > | cwiseMin (const Scalar &other) const | 
|  | 
| const CwiseBinaryOp< std::not_equal_to< Scalar >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder >, const OtherDerived > | cwiseNotEqual (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const | 
|  | 
| EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_quotient_op< Scalar >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder >, const OtherDerived > | cwiseQuotient (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const | 
|  | 
| const CwiseUnaryOp< internal::scalar_sqrt_op< Scalar >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | cwiseSqrt () const | 
|  | 
| Scalar | determinant () const | 
|  | 
| DiagonalReturnType | diagonal () | 
|  | 
| ConstDiagonalReturnType | diagonal () const | 
|  | 
| DiagonalIndexReturnType< Index >::Type | diagonal () | 
|  | 
| ConstDiagonalIndexReturnType< Index >::Type | diagonal () const | 
|  | 
| DiagonalIndexReturnType< DynamicIndex >::Type | diagonal (Index index) | 
|  | 
| ConstDiagonalIndexReturnType< DynamicIndex >::Type | diagonal (Index index) const | 
|  | 
| Index | diagonalSize () const | 
|  | 
| internal::scalar_product_traits< typename internal::traits< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >::Scalar, typename internal::traits< OtherDerived >::Scalar >::ReturnType | dot (const MatrixBase< OtherDerived > &other) const | 
|  | 
| EIGEN_STRONG_INLINE const | EIGEN_CWISE_PRODUCT_RETURN_TYPE (DiagonalProduct< MatrixType, DiagonalType, ProductOrder >, OtherDerived) cwiseProduct(const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const | 
|  | 
| EigenvaluesReturnType | eigenvalues () const | 
|  | Computes the eigenvalues of a matrix.  More... 
 | 
|  | 
| Matrix< Scalar, 3, 1 > | eulerAngles (Index a0, Index a1, Index a2) const | 
|  | 
| const MatrixExponentialReturnValue< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | exp () const | 
|  | 
| const ForceAlignedAccess< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | forceAlignedAccess () const | 
|  | 
| ForceAlignedAccess< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | forceAlignedAccess () | 
|  | 
| internal::add_const_on_value_type< typename internal::conditional< Enable, ForceAlignedAccess< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >, DiagonalProduct< MatrixType, DiagonalType, ProductOrder > & >::type >::type | forceAlignedAccessIf () const | 
|  | 
| internal::conditional< Enable, ForceAlignedAccess< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >, DiagonalProduct< MatrixType, DiagonalType, ProductOrder > & >::type | forceAlignedAccessIf () | 
|  | 
| const FullPivHouseholderQR< PlainObject > | fullPivHouseholderQr () const | 
|  | 
| const FullPivLU< PlainObject > | fullPivLu () const | 
|  | 
| const HNormalizedReturnType | hnormalized () const | 
|  | 
| const HouseholderQR< PlainObject > | householderQr () const | 
|  | 
| RealScalar | hypotNorm () const | 
|  | 
| const ImagReturnType | imag () const | 
|  | 
| NonConstImagReturnType | imag () | 
|  | 
| const internal::inverse_impl< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | inverse () const | 
|  | 
| bool | isDiagonal (const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const | 
|  | 
| bool | isIdentity (const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const | 
|  | 
| bool | isLowerTriangular (const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const | 
|  | 
| bool | isOrthogonal (const MatrixBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const | 
|  | 
| bool | isUnitary (const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const | 
|  | 
| bool | isUpperTriangular (const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const | 
|  | 
| JacobiSVD< PlainObject > | jacobiSvd (unsigned int computationOptions=0) const | 
|  | 
| DiagonalProduct< MatrixType, DiagonalType, ProductOrder > & | lazyAssign (const ProductBase< ProductDerived, Lhs, Rhs > &other) | 
|  | 
| DiagonalProduct< MatrixType, DiagonalType, ProductOrder > & | lazyAssign (const MatrixPowerProduct< MatrixPower, Lhs, Rhs > &other) | 
|  | 
| const LazyProductReturnType< DiagonalProduct< MatrixType, DiagonalType, ProductOrder >, OtherDerived >::Type | lazyProduct (const MatrixBase< OtherDerived > &other) const | 
|  | 
| const LDLT< PlainObject > | ldlt () const | 
|  | 
| const LLT< PlainObject > | llt () const | 
|  | 
| const MatrixLogarithmReturnValue< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | log () const | 
|  | 
| RealScalar | lpNorm () const | 
|  | 
| void | makeHouseholder (EssentialPart &essential, Scalar &tau, RealScalar &beta) const | 
|  | 
| void | makeHouseholderInPlace (Scalar &tau, RealScalar &beta) | 
|  | 
| MatrixBase< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > & | matrix () | 
|  | 
| const MatrixBase< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > & | matrix () const | 
|  | 
| const MatrixFunctionReturnValue< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | matrixFunction (StemFunction f) const | 
|  | 
| NoAlias< DiagonalProduct< MatrixType, DiagonalType, ProductOrder >, Eigen::MatrixBase > | noalias () | 
|  | 
| RealScalar | norm () const | 
|  | 
| void | normalize () | 
|  | 
| const PlainObject | normalized () const | 
|  | 
| bool | operator!= (const MatrixBase< OtherDerived > &other) const | 
|  | 
| const ScalarMultipleReturnType | operator* (const Scalar &scalar) const | 
|  | 
| const CwiseUnaryOp< internal::scalar_multiple2_op< Scalar, std::complex< Scalar > >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | operator* (const std::complex< Scalar > &scalar) const | 
|  | 
| const ProductReturnType< DiagonalProduct< MatrixType, DiagonalType, ProductOrder >, OtherDerived >::Type | operator* (const MatrixBase< OtherDerived > &other) const | 
|  | 
| const DiagonalProduct< DiagonalProduct< MatrixType, DiagonalType, ProductOrder >, DiagonalDerived, OnTheRight > | operator* (const DiagonalBase< DiagonalDerived > &diagonal) const | 
|  | 
| DiagonalProduct< MatrixType, DiagonalType, ProductOrder > & | operator*= (const EigenBase< OtherDerived > &other) | 
|  | 
| DiagonalProduct< MatrixType, DiagonalType, ProductOrder > & | operator+= (const MatrixBase< OtherDerived > &other) | 
|  | 
| const CwiseUnaryOp< internal::scalar_opposite_op< typename internal::traits< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >::Scalar >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | operator- () const | 
|  | 
| DiagonalProduct< MatrixType, DiagonalType, ProductOrder > & | operator-= (const MatrixBase< OtherDerived > &other) | 
|  | 
| const CwiseUnaryOp< internal::scalar_quotient1_op< typename internal::traits< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > >::Scalar >, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | operator/ (const Scalar &scalar) const | 
|  | 
| DiagonalProduct< MatrixType, DiagonalType, ProductOrder > & | operator= (const MatrixBase &other) | 
|  | 
| DiagonalProduct< MatrixType, DiagonalType, ProductOrder > & | operator= (const DenseBase< OtherDerived > &other) | 
|  | 
| DiagonalProduct< MatrixType, DiagonalType, ProductOrder > & | operator= (const EigenBase< OtherDerived > &other) | 
|  | 
| DiagonalProduct< MatrixType, DiagonalType, ProductOrder > & | operator= (const ReturnByValue< OtherDerived > &other) | 
|  | 
| bool | operator== (const MatrixBase< OtherDerived > &other) const | 
|  | 
| RealScalar | operatorNorm () const | 
|  | Computes the L2 operator norm.  More... 
 | 
|  | 
| const PartialPivLU< PlainObject > | partialPivLu () const | 
|  | 
| const MatrixPowerReturnValue< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | pow (const RealScalar &p) const | 
|  | 
| RealReturnType | real () const | 
|  | 
| NonConstRealReturnType | real () | 
|  | 
| SelfAdjointViewReturnType< UpLo >::Type | selfadjointView () | 
|  | 
| ConstSelfAdjointViewReturnType< UpLo >::Type | selfadjointView () const | 
|  | 
| DiagonalProduct< MatrixType, DiagonalType, ProductOrder > & | setIdentity () | 
|  | 
| DiagonalProduct< MatrixType, DiagonalType, ProductOrder > & | setIdentity (Index rows, Index cols) | 
|  | Resizes to the given size, and writes the identity expression (not necessarily square) into *this.  More... 
 | 
|  | 
| const MatrixFunctionReturnValue< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | sin () const | 
|  | 
| const MatrixFunctionReturnValue< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | sinh () const | 
|  | 
| const SparseView< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | sparseView (const Scalar &m_reference=Scalar(0), const typename NumTraits< Scalar >::Real &m_epsilon=NumTraits< Scalar >::dummy_precision()) const | 
|  | 
| const MatrixSquareRootReturnValue< DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | sqrt () const | 
|  | 
| RealScalar | squaredNorm () const | 
|  | 
| RealScalar | stableNorm () const | 
|  | 
| Scalar | trace () const | 
|  | 
| TriangularViewReturnType< Mode >::Type | triangularView () | 
|  | 
| ConstTriangularViewReturnType< Mode >::Type | triangularView () const | 
|  | 
| const CwiseUnaryOp< CustomUnaryOp, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | unaryExpr (const CustomUnaryOp &func=CustomUnaryOp()) const | 
|  | Apply a unary operator coefficient-wise.  More... 
 | 
|  | 
| const CwiseUnaryView< CustomViewOp, const DiagonalProduct< MatrixType, DiagonalType, ProductOrder > > | unaryViewExpr (const CustomViewOp &func=CustomViewOp()) const | 
|  | 
| PlainObject | unitOrthogonal (void) const | 
|  | 
| bool | all (void) const | 
|  | 
| bool | allFinite () const | 
|  | 
| bool | any (void) const | 
|  | 
| Block< Derived > | block (Index startRow, Index startCol, Index blockRows, Index blockCols) | 
|  | 
| const Block< const Derived > | block (Index startRow, Index startCol, Index blockRows, Index blockCols) const | 
|  | 
| template<int BlockRows, int BlockCols> | 
| Block< Derived, BlockRows, BlockCols > | block (Index startRow, Index startCol) | 
|  | 
| template<int BlockRows, int BlockCols> | 
| const Block< const Derived, BlockRows, BlockCols > | block (Index startRow, Index startCol) const | 
|  | 
| template<int BlockRows, int BlockCols> | 
| Block< Derived, BlockRows, BlockCols > | block (Index startRow, Index startCol, Index blockRows, Index blockCols) | 
|  | 
| template<int BlockRows, int BlockCols> | 
| const Block< const Derived, BlockRows, BlockCols > | block (Index startRow, Index startCol, Index blockRows, Index blockCols) const | 
|  | 
| Block< Derived > | bottomLeftCorner (Index cRows, Index cCols) | 
|  | 
| const Block< const Derived > | bottomLeftCorner (Index cRows, Index cCols) const | 
|  | 
| template<int CRows, int CCols> | 
| Block< Derived, CRows, CCols > | bottomLeftCorner () | 
|  | 
| template<int CRows, int CCols> | 
| const Block< const Derived, CRows, CCols > | bottomLeftCorner () const | 
|  | 
| template<int CRows, int CCols> | 
| Block< Derived, CRows, CCols > | bottomLeftCorner (Index cRows, Index cCols) | 
|  | 
| template<int CRows, int CCols> | 
| const Block< const Derived, CRows, CCols > | bottomLeftCorner (Index cRows, Index cCols) const | 
|  | 
| Block< Derived > | bottomRightCorner (Index cRows, Index cCols) | 
|  | 
| const Block< const Derived > | bottomRightCorner (Index cRows, Index cCols) const | 
|  | 
| template<int CRows, int CCols> | 
| Block< Derived, CRows, CCols > | bottomRightCorner () | 
|  | 
| template<int CRows, int CCols> | 
| const Block< const Derived, CRows, CCols > | bottomRightCorner () const | 
|  | 
| template<int CRows, int CCols> | 
| Block< Derived, CRows, CCols > | bottomRightCorner (Index cRows, Index cCols) | 
|  | 
| template<int CRows, int CCols> | 
| const Block< const Derived, CRows, CCols > | bottomRightCorner (Index cRows, Index cCols) const | 
|  | 
| RowsBlockXpr | bottomRows (Index n) | 
|  | 
| ConstRowsBlockXpr | bottomRows (Index n) const | 
|  | 
| template<int N> | 
| NRowsBlockXpr< N >::Type | bottomRows () | 
|  | 
| template<int N> | 
| ConstNRowsBlockXpr< N >::Type | bottomRows () const | 
|  | 
| ColXpr | col (Index i) | 
|  | 
| ConstColXpr | col (Index i) const | 
|  | 
| ConstColwiseReturnType | colwise () const | 
|  | 
| ColwiseReturnType | colwise () | 
|  | 
| Index | count () const | 
|  | 
| EIGEN_STRONG_INLINE EvalReturnType | eval () const | 
|  | 
| template<typename Dest > | 
| void | evalTo (Dest &) const | 
|  | 
| void | fill (const Scalar &value) | 
|  | 
| template<unsigned int Added, unsigned int Removed> | 
| const Flagged< Derived, Added, Removed > | flagged () const | 
|  | 
| const ForceAlignedAccess< Derived > | forceAlignedAccess () const | 
|  | 
| ForceAlignedAccess< Derived > | forceAlignedAccess () | 
|  | 
| template<bool Enable> | 
| const internal::conditional< Enable, ForceAlignedAccess< Derived >, Derived & >::type | forceAlignedAccessIf () const | 
|  | 
| template<bool Enable> | 
| internal::conditional< Enable, ForceAlignedAccess< Derived >, Derived & >::type | forceAlignedAccessIf () | 
|  | 
| const WithFormat< Derived > | format (const IOFormat &fmt) const | 
|  | 
| bool | hasNaN () const | 
|  | 
| SegmentReturnType | head (Index vecSize) | 
|  | 
| ConstSegmentReturnType | head (Index vecSize) const | 
|  | 
| template<int Size> | 
| FixedSegmentReturnType< Size >::Type | head () | 
|  | 
| template<int Size> | 
| ConstFixedSegmentReturnType< Size >::Type | head () const | 
|  | 
| Index | innerSize () const | 
|  | 
| template<typename OtherDerived > | 
| bool | isApprox (const DenseBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const | 
|  | 
| bool | isApproxToConstant (const Scalar &value, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const | 
|  | 
| bool | isConstant (const Scalar &value, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const | 
|  | 
| template<typename Derived > | 
| bool | isMuchSmallerThan (const typename NumTraits< Scalar >::Real &other, const RealScalar &prec) const | 
|  | 
| bool | isMuchSmallerThan (const RealScalar &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const | 
|  | 
| template<typename OtherDerived > | 
| bool | isMuchSmallerThan (const DenseBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const | 
|  | 
| bool | isOnes (const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const | 
|  | 
| bool | isZero (const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const | 
|  | 
| template<typename OtherDerived > | 
| Derived & | lazyAssign (const DenseBase< OtherDerived > &other) | 
|  | 
| template<typename OtherDerived > | 
| EIGEN_STRONG_INLINE Derived & | lazyAssign (const DenseBase< OtherDerived > &other) | 
|  | 
| ColsBlockXpr | leftCols (Index n) | 
|  | 
| ConstColsBlockXpr | leftCols (Index n) const | 
|  | 
| template<int N> | 
| NColsBlockXpr< N >::Type | leftCols () | 
|  | 
| template<int N> | 
| ConstNColsBlockXpr< N >::Type | leftCols () const | 
|  | 
| template<int p> | 
| RealScalar | lpNorm () const | 
|  | 
| internal::traits< Derived >::Scalar | maxCoeff () const | 
|  | 
| template<typename IndexType > | 
| internal::traits< Derived >::Scalar | maxCoeff (IndexType *row, IndexType *col) const | 
|  | 
| template<typename IndexType > | 
| internal::traits< Derived >::Scalar | maxCoeff (IndexType *index) const | 
|  | 
| Scalar | mean () const | 
|  | 
| ColsBlockXpr | middleCols (Index startCol, Index numCols) | 
|  | 
| ConstColsBlockXpr | middleCols (Index startCol, Index numCols) const | 
|  | 
| template<int N> | 
| NColsBlockXpr< N >::Type | middleCols (Index startCol) | 
|  | 
| template<int N> | 
| ConstNColsBlockXpr< N >::Type | middleCols (Index startCol) const | 
|  | 
| RowsBlockXpr | middleRows (Index startRow, Index numRows) | 
|  | 
| ConstRowsBlockXpr | middleRows (Index startRow, Index numRows) const | 
|  | 
| template<int N> | 
| NRowsBlockXpr< N >::Type | middleRows (Index startRow) | 
|  | 
| template<int N> | 
| ConstNRowsBlockXpr< N >::Type | middleRows (Index startRow) const | 
|  | 
| internal::traits< Derived >::Scalar | minCoeff () const | 
|  | 
| template<typename IndexType > | 
| internal::traits< Derived >::Scalar | minCoeff (IndexType *row, IndexType *col) const | 
|  | 
| template<typename IndexType > | 
| internal::traits< Derived >::Scalar | minCoeff (IndexType *index) const | 
|  | 
| const NestByValue< Derived > | nestByValue () const | 
|  | 
| Index | nonZeros () const | 
|  | 
| template<typename CustomNullaryOp > | 
| EIGEN_STRONG_INLINE const CwiseNullaryOp< CustomNullaryOp, Derived > | NullaryExpr (Index rows, Index cols, const CustomNullaryOp &func) | 
|  | 
| template<typename CustomNullaryOp > | 
| EIGEN_STRONG_INLINE const CwiseNullaryOp< CustomNullaryOp, Derived > | NullaryExpr (Index size, const CustomNullaryOp &func) | 
|  | 
| template<typename CustomNullaryOp > | 
| EIGEN_STRONG_INLINE const CwiseNullaryOp< CustomNullaryOp, Derived > | NullaryExpr (const CustomNullaryOp &func) | 
|  | 
| Derived & | operator*= (const Scalar &other) | 
|  | 
| template<typename OtherDerived > | 
| Derived & | operator+= (const EigenBase< OtherDerived > &other) | 
|  | 
| template<typename OtherDerived > | 
| Derived & | operator-= (const EigenBase< OtherDerived > &other) | 
|  | 
| Derived & | operator/= (const Scalar &other) | 
|  | 
| CommaInitializer< Derived > | operator<< (const Scalar &s) | 
|  | 
| template<typename OtherDerived > | 
| CommaInitializer< Derived > | operator<< (const DenseBase< OtherDerived > &other) | 
|  | 
| template<typename OtherDerived > | 
| Derived & | operator= (const DenseBase< OtherDerived > &other) | 
|  | 
| Derived & | operator= (const DenseBase &other) | 
|  | 
| template<typename OtherDerived > | 
| Derived & | operator= (const EigenBase< OtherDerived > &other) | 
|  | Copies the generic expression other into *this.  More... 
 | 
|  | 
| template<typename OtherDerived > | 
| Derived & | operator= (const ReturnByValue< OtherDerived > &func) | 
|  | 
| template<typename OtherDerived > | 
| EIGEN_STRONG_INLINE Derived & | operator= (const DenseBase< OtherDerived > &other) | 
|  | 
| Index | outerSize () const | 
|  | 
| Scalar | prod () const | 
|  | 
| template<typename Func > | 
| EIGEN_STRONG_INLINE internal::result_of< Func(typename internal::traits< Derived >::Scalar)>::type | redux (const Func &func) const | 
|  | 
| template<typename BinaryOp > | 
| internal::result_of< BinaryOp(typename internal::traits< Derived >::Scalar)>::type | redux (const BinaryOp &func) const | 
|  | 
| template<int RowFactor, int ColFactor> | 
| const Replicate< Derived, RowFactor, ColFactor > | replicate () const | 
|  | 
| const Replicate< Derived, Dynamic, Dynamic > | replicate (Index rowFacor, Index colFactor) const | 
|  | 
| void | resize (Index newSize) | 
|  | 
| void | resize (Index nbRows, Index nbCols) | 
|  | 
| ReverseReturnType | reverse () | 
|  | 
| ConstReverseReturnType | reverse () const | 
|  | 
| void | reverseInPlace () | 
|  | 
| ColsBlockXpr | rightCols (Index n) | 
|  | 
| ConstColsBlockXpr | rightCols (Index n) const | 
|  | 
| template<int N> | 
| NColsBlockXpr< N >::Type | rightCols () | 
|  | 
| template<int N> | 
| ConstNColsBlockXpr< N >::Type | rightCols () const | 
|  | 
| RowXpr | row (Index i) | 
|  | 
| ConstRowXpr | row (Index i) const | 
|  | 
| ConstRowwiseReturnType | rowwise () const | 
|  | 
| RowwiseReturnType | rowwise () | 
|  | 
| SegmentReturnType | segment (Index start, Index vecSize) | 
|  | 
| ConstSegmentReturnType | segment (Index start, Index vecSize) const | 
|  | 
| template<int Size> | 
| FixedSegmentReturnType< Size >::Type | segment (Index start) | 
|  | 
| template<int Size> | 
| ConstFixedSegmentReturnType< Size >::Type | segment (Index start) const | 
|  | 
| template<typename ThenDerived , typename ElseDerived > | 
| const Select< Derived, ThenDerived, ElseDerived > | select (const DenseBase< ThenDerived > &thenMatrix, const DenseBase< ElseDerived > &elseMatrix) const | 
|  | 
| template<typename ThenDerived > | 
| const Select< Derived, ThenDerived, typename ThenDerived::ConstantReturnType > | select (const DenseBase< ThenDerived > &thenMatrix, const typename ThenDerived::Scalar &elseScalar) const | 
|  | 
| template<typename ElseDerived > | 
| const Select< Derived, typename ElseDerived::ConstantReturnType, ElseDerived > | select (const typename ElseDerived::Scalar &thenScalar, const DenseBase< ElseDerived > &elseMatrix) const | 
|  | 
| Derived & | setConstant (const Scalar &value) | 
|  | 
| Derived & | setLinSpaced (Index size, const Scalar &low, const Scalar &high) | 
|  | Sets a linearly space vector.  More... 
 | 
|  | 
| Derived & | setLinSpaced (const Scalar &low, const Scalar &high) | 
|  | Sets a linearly space vector.  More... 
 | 
|  | 
| Derived & | setOnes () | 
|  | 
| Derived & | setRandom () | 
|  | 
| Derived & | setZero () | 
|  | 
| Scalar | sum () const | 
|  | 
| template<typename OtherDerived > | 
| void | swap (const DenseBase< OtherDerived > &other, int=OtherDerived::ThisConstantIsPrivateInPlainObjectBase) | 
|  | 
| template<typename OtherDerived > | 
| void | swap (PlainObjectBase< OtherDerived > &other) | 
|  | 
| SegmentReturnType | tail (Index vecSize) | 
|  | 
| ConstSegmentReturnType | tail (Index vecSize) const | 
|  | 
| template<int Size> | 
| FixedSegmentReturnType< Size >::Type | tail () | 
|  | 
| template<int Size> | 
| ConstFixedSegmentReturnType< Size >::Type | tail () const | 
|  | 
| Block< Derived > | topLeftCorner (Index cRows, Index cCols) | 
|  | 
| const Block< const Derived > | topLeftCorner (Index cRows, Index cCols) const | 
|  | 
| template<int CRows, int CCols> | 
| Block< Derived, CRows, CCols > | topLeftCorner () | 
|  | 
| template<int CRows, int CCols> | 
| const Block< const Derived, CRows, CCols > | topLeftCorner () const | 
|  | 
| template<int CRows, int CCols> | 
| Block< Derived, CRows, CCols > | topLeftCorner (Index cRows, Index cCols) | 
|  | 
| template<int CRows, int CCols> | 
| const Block< const Derived, CRows, CCols > | topLeftCorner (Index cRows, Index cCols) const | 
|  | 
| Block< Derived > | topRightCorner (Index cRows, Index cCols) | 
|  | 
| const Block< const Derived > | topRightCorner (Index cRows, Index cCols) const | 
|  | 
| template<int CRows, int CCols> | 
| Block< Derived, CRows, CCols > | topRightCorner () | 
|  | 
| template<int CRows, int CCols> | 
| const Block< const Derived, CRows, CCols > | topRightCorner () const | 
|  | 
| template<int CRows, int CCols> | 
| Block< Derived, CRows, CCols > | topRightCorner (Index cRows, Index cCols) | 
|  | 
| template<int CRows, int CCols> | 
| const Block< const Derived, CRows, CCols > | topRightCorner (Index cRows, Index cCols) const | 
|  | 
| RowsBlockXpr | topRows (Index n) | 
|  | 
| ConstRowsBlockXpr | topRows (Index n) const | 
|  | 
| template<int N> | 
| NRowsBlockXpr< N >::Type | topRows () | 
|  | 
| template<int N> | 
| ConstNRowsBlockXpr< N >::Type | topRows () const | 
|  | 
| Scalar | trace () const | 
|  | 
| Eigen::Transpose< Derived > | transpose () | 
|  | 
| ConstTransposeReturnType | transpose () const | 
|  | 
| void | transposeInPlace () | 
|  | 
| CoeffReturnType | value () const | 
|  | 
| template<typename Visitor > | 
| void | visit (Visitor &func) const | 
|  | 
| void | operator* () const | 
|  |