Public Types | Public Member Functions | Protected Attributes | List of all members
Eigen::MatrixWrapper< ExpressionType > Class Template Reference

Expression of an array as a mathematical vector or matrix. More...

#include <ArrayBase.h>

Inheritance diagram for Eigen::MatrixWrapper< ExpressionType >:
Inheritance graph
[legend]

Public Types

typedef MatrixBase< MatrixWrapper< ExpressionType > > Base
 
typedef internal::remove_all< ExpressionType >::type NestedExpression
 
typedef internal::ref_selector< ExpressionType >::non_const_type NestedExpressionType
 
typedef internal::conditional< internal::is_lvalue< ExpressionType >::value, Scalar, const Scalar >::type ScalarWithConstIfNotLvalue
 
- Public Types inherited from Eigen::MatrixBase< MatrixWrapper< ExpressionType > >
enum  
 
enum  
 
typedef internal::conditional< NumTraits< Scalar >::IsComplex, CwiseUnaryOp< internal::scalar_conjugate_op< Scalar >, ConstTransposeReturnType >, ConstTransposeReturnType >::type AdjointReturnType
 
typedef DenseBase< MatrixWrapper< ExpressionType > > Base
 
typedef Block< const CwiseNullaryOp< internal::scalar_identity_op< Scalar >, SquareMatrixType >, internal::traits< MatrixWrapper< ExpressionType > >::RowsAtCompileTime, internal::traits< MatrixWrapper< ExpressionType > >::ColsAtCompileTimeBasisReturnType
 
typedef Base::CoeffReturnType CoeffReturnType
 
typedef Base::ColXpr ColXpr
 
typedef internal::conditional< NumTraits< Scalar >::IsComplex, const CwiseUnaryOp< internal::scalar_conjugate_op< Scalar >, const MatrixWrapper< ExpressionType > >, const MatrixWrapper< ExpressionType > & >::type ConjugateReturnType
 
typedef CwiseNullaryOp< internal::scalar_constant_op< Scalar >, PlainObjectConstantReturnType
 
typedef internal::add_const< Diagonal< const MatrixWrapper< ExpressionType >, DynamicIndex > >::type ConstDiagonalDynamicIndexReturnType
 
typedef internal::add_const< Diagonal< const MatrixWrapper< ExpressionType > > >::type ConstDiagonalReturnType
 
typedef Block< const MatrixWrapper< ExpressionType >, internal::traits< MatrixWrapper< ExpressionType > >::ColsAtCompileTime==1?SizeMinusOne:1, internal::traits< MatrixWrapper< ExpressionType > >::ColsAtCompileTime==1?1:SizeMinusOneConstStartMinusOne
 
typedef Base::ConstTransposeReturnType ConstTransposeReturnType
 
typedef CwiseUnaryOp< internal::scalar_abs2_op< Scalar >, const MatrixWrapper< ExpressionType > > CwiseAbs2ReturnType
 
typedef CwiseUnaryOp< internal::scalar_abs_op< Scalar >, const MatrixWrapper< ExpressionType > > CwiseAbsReturnType
 
typedef CwiseUnaryOp< internal::scalar_inverse_op< Scalar >, const MatrixWrapper< ExpressionType > > CwiseInverseReturnType
 
typedef CwiseBinaryOp< internal::scalar_cmp_op< Scalar, Scalar, internal::cmp_EQ >, const MatrixWrapper< ExpressionType >, const ConstantReturnTypeCwiseScalarEqualReturnType
 
typedef CwiseUnaryOp< internal::scalar_sign_op< Scalar >, const MatrixWrapper< ExpressionType > > CwiseSignReturnType
 
typedef CwiseUnaryOp< internal::scalar_sqrt_op< Scalar >, const MatrixWrapper< ExpressionType > > CwiseSqrtReturnType
 
typedef Diagonal< MatrixWrapper< ExpressionType >, DynamicIndex > DiagonalDynamicIndexReturnType
 
typedef Diagonal< MatrixWrapper< ExpressionType > > DiagonalReturnType
 
typedef Matrix< std::complex< RealScalar >, internal::traits< MatrixWrapper< ExpressionType > >::ColsAtCompileTime, 1, ColMajor > EigenvaluesReturnType
 
typedef Homogeneous< MatrixWrapper< ExpressionType >, HomogeneousReturnTypeDirectionHomogeneousReturnType
 
typedef CwiseNullaryOp< internal::scalar_identity_op< Scalar >, PlainObjectIdentityReturnType
 
typedef CwiseUnaryOp< internal::scalar_imag_op< Scalar >, const MatrixWrapper< ExpressionType > > ImagReturnType
 
typedef CwiseUnaryOp< internal::scalar_opposite_op< Scalar >, const MatrixWrapper< ExpressionType > > NegativeReturnType
 
typedef CwiseUnaryView< internal::scalar_imag_ref_op< Scalar >, MatrixWrapper< ExpressionType > > NonConstImagReturnType
 
typedef internal::conditional< NumTraits< Scalar >::IsComplex, CwiseUnaryView< internal::scalar_real_ref_op< Scalar >, MatrixWrapper< ExpressionType > >, MatrixWrapper< ExpressionType > & >::type NonConstRealReturnType
 
typedef internal::packet_traits< Scalar >::type PacketScalar
 
typedef Base::PlainObject PlainObject
 
typedef internal::conditional< NumTraits< Scalar >::IsComplex, const CwiseUnaryOp< internal::scalar_real_op< Scalar >, const MatrixWrapper< ExpressionType > >, const MatrixWrapper< ExpressionType > & >::type RealReturnType
 
typedef NumTraits< Scalar >::Real RealScalar
 
typedef Base::RowXpr RowXpr
 
typedef internal::traits< MatrixWrapper< ExpressionType > >::Scalar Scalar
 
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< MatrixWrapper< ExpressionType > >::StorageIndex StorageIndex
 
typedef internal::traits< MatrixWrapper< ExpressionType > >::StorageKind StorageKind
 
- Public Types inherited from Eigen::DenseBase< Derived >
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, InnerStrideAtCompileTime = internal::inner_stride_at_compile_time<Derived>::ret, OuterStrideAtCompileTime = internal::outer_stride_at_compile_time<Derived>::ret
}
 
enum  { IsPlainObjectBase = 0 }
 
typedef DenseCoeffsBase< Derived > Base
 
typedef Block< Derived > BlockXpr
 
typedef Base::CoeffReturnType CoeffReturnType
 
typedef Block< Derived, internal::traits< Derived >::RowsAtCompileTime, Dynamic,!IsRowMajorColsBlockXpr
 
typedef VectorwiseOp< Derived, VerticalColwiseReturnType
 
typedef Block< Derived, internal::traits< Derived >::RowsAtCompileTime, 1,!IsRowMajorColXpr
 
typedef CwiseNullaryOp< internal::scalar_constant_op< Scalar >, PlainObjectConstantReturnType
 
typedef const Block< const Derived > ConstBlockXpr
 
typedef const Block< const Derived, internal::traits< Derived >::RowsAtCompileTime, Dynamic,!IsRowMajorConstColsBlockXpr
 
typedef const VectorwiseOp< const Derived, VerticalConstColwiseReturnType
 
typedef const Block< const Derived, internal::traits< Derived >::RowsAtCompileTime, 1,!IsRowMajorConstColXpr
 
typedef const Reverse< const Derived, BothDirectionsConstReverseReturnType
 
typedef const Block< const Derived, Dynamic, internal::traits< Derived >::ColsAtCompileTime, IsRowMajorConstRowsBlockXpr
 
typedef const VectorwiseOp< const Derived, HorizontalConstRowwiseReturnType
 
typedef const Block< const Derived, 1, internal::traits< Derived >::ColsAtCompileTime, IsRowMajorConstRowXpr
 
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 Eigen::InnerIterator< Derived > InnerIterator
 
typedef internal::find_best_packet< Scalar, SizeAtCompileTime >::type PacketScalar
 
typedef Array< typename internal::traits< Derived >::Scalar, internal::traits< Derived >::RowsAtCompileTime, internal::traits< Derived >::ColsAtCompileTime, AutoAlign|(internal::traits< Derived >::Flags &RowMajorBit?RowMajor:ColMajor), internal::traits< Derived >::MaxRowsAtCompileTime, internal::traits< Derived >::MaxColsAtCompileTimePlainArray
 
typedef Matrix< typename internal::traits< Derived >::Scalar, internal::traits< Derived >::RowsAtCompileTime, internal::traits< Derived >::ColsAtCompileTime, AutoAlign|(internal::traits< Derived >::Flags &RowMajorBit?RowMajor:ColMajor), internal::traits< Derived >::MaxRowsAtCompileTime, internal::traits< Derived >::MaxColsAtCompileTimePlainMatrix
 
typedef internal::conditional< internal::is_same< typename internal::traits< Derived >::XprKind, MatrixXpr >::value, PlainMatrix, PlainArray >::type PlainObject
 The plain matrix or array type corresponding to this expression. More...
 
typedef CwiseNullaryOp< internal::linspaced_op< Scalar, PacketScalar >, PlainObjectRandomAccessLinSpacedReturnType
 
typedef CwiseNullaryOp< internal::scalar_random_op< Scalar >, PlainObjectRandomReturnType
 
typedef NumTraits< Scalar >::Real RealScalar
 
typedef Reverse< Derived, BothDirectionsReverseReturnType
 
typedef Block< Derived, Dynamic, internal::traits< Derived >::ColsAtCompileTime, IsRowMajorRowsBlockXpr
 
typedef VectorwiseOp< Derived, HorizontalRowwiseReturnType
 
typedef Block< Derived, 1, internal::traits< Derived >::ColsAtCompileTime, IsRowMajorRowXpr
 
typedef internal::traits< Derived >::Scalar Scalar
 
typedef VectorBlock< Derived > SegmentReturnType
 
typedef CwiseNullaryOp< internal::linspaced_op< Scalar, PacketScalar >, PlainObjectSequentialLinSpacedReturnType
 
typedef internal::traits< Derived >::StorageIndex StorageIndex
 The type used to store indices. More...
 
typedef internal::traits< Derived >::StorageKind StorageKind
 
typedef Transpose< Derived > TransposeReturnType
 
typedef Scalar value_type
 

Public Member Functions

EIGEN_DEVICE_FUNC const ScalarcoeffRef (Index rowId, Index colId) const
 
EIGEN_DEVICE_FUNC const ScalarcoeffRef (Index index) const
 
EIGEN_DEVICE_FUNC Index cols () const
 
EIGEN_DEVICE_FUNC ScalarWithConstIfNotLvaluedata ()
 
EIGEN_DEVICE_FUNC const Scalardata () const
 
EIGEN_DEVICE_FUNC Index innerStride () const
 
EIGEN_DEVICE_FUNC MatrixWrapper (ExpressionType &matrix)
 
EIGEN_DEVICE_FUNC const internal::remove_all< NestedExpressionType >::type & nestedExpression () const
 
EIGEN_DEVICE_FUNC Index outerStride () const
 
EIGEN_DEVICE_FUNC void resize (Index newSize)
 
EIGEN_DEVICE_FUNC void resize (Index rows, Index cols)
 
EIGEN_DEVICE_FUNC Index rows () const
 
- Public Member Functions inherited from Eigen::MatrixBase< MatrixWrapper< ExpressionType > >
EIGEN_DEVICE_FUNC const AdjointReturnType adjoint () const
 
EIGEN_DEVICE_FUNC 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)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ArrayWrapper< MatrixWrapper< ExpressionType > > array ()
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ArrayWrapper< const MatrixWrapper< ExpressionType > > array () const
 
EIGEN_DEVICE_FUNC const DiagonalWrapper< const MatrixWrapper< ExpressionType > > asDiagonal () const
 
const PermutationWrapper< const MatrixWrapper< ExpressionType > > asPermutation () const
 
BDCSVD< PlainObjectbdcSvd (unsigned int computationOptions=0) const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseBinaryOp< CustomBinaryOp, const MatrixWrapper< ExpressionType >, const OtherDerived > binaryExpr (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other, const CustomBinaryOp &func=CustomBinaryOp()) const
 
RealScalar blueNorm () const
 
EIGEN_DEVICE_FUNC CastXpr< NewType >::Type cast () const
 
const ColPivHouseholderQR< PlainObjectcolPivHouseholderQr () const
 
const CompleteOrthogonalDecomposition< PlainObjectcompleteOrthogonalDecomposition () 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
 
EIGEN_DEVICE_FUNC ConjugateReturnType conjugate () const
 
const MatrixFunctionReturnValue< MatrixWrapper< ExpressionType > > cos () const
 
const MatrixFunctionReturnValue< MatrixWrapper< ExpressionType > > cosh () const
 
EIGEN_DEVICE_FUNC cross_product_return_type< OtherDerived >::type cross (const MatrixBase< OtherDerived > &other) const
 
EIGEN_DEVICE_FUNC PlainObject cross3 (const MatrixBase< OtherDerived > &other) const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseAbsReturnType cwiseAbs () const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseAbs2ReturnType cwiseAbs2 () const
 
EIGEN_DEVICE_FUNC const CwiseBinaryOp< std::equal_to< Scalar >, const MatrixWrapper< ExpressionType >, const OtherDerived > cwiseEqual (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
EIGEN_DEVICE_FUNC const CwiseScalarEqualReturnType cwiseEqual (const Scalar &s) const
 
EIGEN_DEVICE_FUNC const CwiseInverseReturnType cwiseInverse () const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_max_op< Scalar, Scalar >, const MatrixWrapper< ExpressionType >, const OtherDerived > cwiseMax (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_max_op< Scalar, Scalar >, const MatrixWrapper< ExpressionType >, const ConstantReturnTypecwiseMax (const Scalar &other) const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_min_op< Scalar, Scalar >, const MatrixWrapper< ExpressionType >, const OtherDerived > cwiseMin (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_min_op< Scalar, Scalar >, const MatrixWrapper< ExpressionType >, const ConstantReturnTypecwiseMin (const Scalar &other) const
 
EIGEN_DEVICE_FUNC const CwiseBinaryOp< std::not_equal_to< Scalar >, const MatrixWrapper< ExpressionType >, const OtherDerived > cwiseNotEqual (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
EIGEN_STRONG_INLINE const SparseMatrixBase< OtherDerived >::template CwiseProductDenseReturnType< MatrixWrapper< ExpressionType > >::Type cwiseProduct (const SparseMatrixBase< OtherDerived > &other) const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_quotient_op< Scalar >, const MatrixWrapper< ExpressionType >, const OtherDerived > cwiseQuotient (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
EIGEN_DEVICE_FUNC const CwiseSignReturnType cwiseSign () const
 
EIGEN_DEVICE_FUNC const CwiseSqrtReturnType cwiseSqrt () const
 
Scalar determinant () const
 
EIGEN_DEVICE_FUNC DiagonalReturnType diagonal ()
 
EIGEN_DEVICE_FUNC ConstDiagonalReturnType diagonal () const
 
EIGEN_DEVICE_FUNC DiagonalIndexReturnType< Index >::Type diagonal ()
 
EIGEN_DEVICE_FUNC ConstDiagonalIndexReturnType< Index >::Type diagonal () const
 
EIGEN_DEVICE_FUNC DiagonalDynamicIndexReturnType diagonal (Index index)
 
EIGEN_DEVICE_FUNC ConstDiagonalDynamicIndexReturnType diagonal (Index index) const
 
EIGEN_DEVICE_FUNC Index diagonalSize () const
 
EIGEN_DEVICE_FUNC ScalarBinaryOpTraits< typename internal::traits< MatrixWrapper< ExpressionType > >::Scalar, typename internal::traits< OtherDerived >::Scalar >::ReturnType dot (const MatrixBase< OtherDerived > &other) const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const EIGEN_CWISE_BINARY_RETURN_TYPE (MatrixWrapper< ExpressionType >, OtherDerived, product) cwiseProduct(const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
typedef EIGEN_EXPR_BINARYOP_SCALAR_RETURN_TYPE (ConstStartMinusOne, Scalar, quotient) HNormalizedReturnType
 
EigenvaluesReturnType eigenvalues () const
 Computes the eigenvalues of a matrix. More...
 
EIGEN_DEVICE_FUNC Matrix< Scalar, 3, 1 > eulerAngles (Index a0, Index a1, Index a2) const
 
const MatrixExponentialReturnValue< MatrixWrapper< ExpressionType > > exp () const
 
const MatrixWrapper< ExpressionType > & forceAlignedAccess () const
 
MatrixWrapper< ExpressionType > & forceAlignedAccess ()
 
const MatrixWrapper< ExpressionType > & forceAlignedAccessIf () const
 
MatrixWrapper< ExpressionType > & forceAlignedAccessIf ()
 
const FullPivHouseholderQR< PlainObjectfullPivHouseholderQr () const
 
const FullPivLU< PlainObjectfullPivLu () const
 
EIGEN_DEVICE_FUNC const HNormalizedReturnType hnormalized () const
 homogeneous normalization More...
 
EIGEN_DEVICE_FUNC HomogeneousReturnType homogeneous () const
 
const HouseholderQR< PlainObjecthouseholderQr () const
 
RealScalar hypotNorm () const
 
EIGEN_DEVICE_FUNC const ImagReturnType imag () const
 
EIGEN_DEVICE_FUNC NonConstImagReturnType imag ()
 
const Inverse< MatrixWrapper< ExpressionType > > 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< PlainObjectjacobiSvd (unsigned int computationOptions=0) const
 
EIGEN_DEVICE_FUNC const Product< MatrixWrapper< ExpressionType >, OtherDerived, LazyProduct > lazyProduct (const MatrixBase< OtherDerived > &other) const
 
const LDLT< PlainObjectldlt () const
 
const LLT< PlainObjectllt () const
 
const MatrixLogarithmReturnValue< MatrixWrapper< ExpressionType > > log () const
 
EIGEN_DEVICE_FUNC RealScalar lpNorm () const
 
const PartialPivLU< PlainObjectlu () const
 
void makeHouseholder (EssentialPart &essential, Scalar &tau, RealScalar &beta) const
 
void makeHouseholderInPlace (Scalar &tau, RealScalar &beta)
 
EIGEN_DEVICE_FUNC MatrixBase< MatrixWrapper< ExpressionType > > & matrix ()
 
EIGEN_DEVICE_FUNC const MatrixBase< MatrixWrapper< ExpressionType > > & matrix () const
 
const MatrixFunctionReturnValue< MatrixWrapper< ExpressionType > > matrixFunction (StemFunction f) const
 
NoAlias< MatrixWrapper< ExpressionType >, Eigen::MatrixBasenoalias ()
 
EIGEN_DEVICE_FUNC RealScalar norm () const
 
EIGEN_DEVICE_FUNC void normalize ()
 
EIGEN_DEVICE_FUNC const PlainObject normalized () const
 
EIGEN_DEVICE_FUNC bool operator!= (const MatrixBase< OtherDerived > &other) const
 
EIGEN_DEVICE_FUNC const CwiseBinaryOp< internal::scalar_boolean_and_op, const MatrixWrapper< ExpressionType >, const OtherDerived > operator&& (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
const Product< MatrixWrapper< ExpressionType >, OtherDerived > operator* (const MatrixBase< OtherDerived > &other) const
 
EIGEN_DEVICE_FUNC const Product< MatrixWrapper< ExpressionType >, DiagonalDerived, LazyProduct > operator* (const DiagonalBase< DiagonalDerived > &diagonal) const
 
MatrixWrapper< ExpressionType > & operator*= (const EigenBase< OtherDerived > &other)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE MatrixWrapper< ExpressionType > & operator+= (const MatrixBase< OtherDerived > &other)
 
EIGEN_DEVICE_FUNC const NegativeReturnType operator- () const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE MatrixWrapper< ExpressionType > & operator-= (const MatrixBase< OtherDerived > &other)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE MatrixWrapper< ExpressionType > & operator= (const MatrixBase &other)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE MatrixWrapper< ExpressionType > & operator= (const DenseBase< OtherDerived > &other)
 
EIGEN_DEVICE_FUNC MatrixWrapper< ExpressionType > & operator= (const EigenBase< OtherDerived > &other)
 
EIGEN_DEVICE_FUNC MatrixWrapper< ExpressionType > & operator= (const ReturnByValue< OtherDerived > &other)
 
EIGEN_DEVICE_FUNC bool operator== (const MatrixBase< OtherDerived > &other) const
 
RealScalar operatorNorm () const
 Computes the L2 operator norm. More...
 
EIGEN_DEVICE_FUNC const CwiseBinaryOp< internal::scalar_boolean_or_op, const MatrixWrapper< ExpressionType >, const OtherDerived > operator|| (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
const PartialPivLU< PlainObjectpartialPivLu () const
 
const MatrixPowerReturnValue< MatrixWrapper< ExpressionType > > pow (const RealScalar &p) const
 
const MatrixComplexPowerReturnValue< MatrixWrapper< ExpressionType > > pow (const std::complex< RealScalar > &p) const
 
EIGEN_DEVICE_FUNC RealReturnType real () const
 
EIGEN_DEVICE_FUNC NonConstRealReturnType real ()
 
EIGEN_DEVICE_FUNC SelfAdjointViewReturnType< UpLo >::Type selfadjointView ()
 
EIGEN_DEVICE_FUNC ConstSelfAdjointViewReturnType< UpLo >::Type selfadjointView () const
 
EIGEN_DEVICE_FUNC MatrixWrapper< ExpressionType > & setIdentity ()
 
EIGEN_DEVICE_FUNC MatrixWrapper< ExpressionType > & setIdentity (Index rows, Index cols)
 Resizes to the given size, and writes the identity expression (not necessarily square) into *this. More...
 
const MatrixFunctionReturnValue< MatrixWrapper< ExpressionType > > sin () const
 
const MatrixFunctionReturnValue< MatrixWrapper< ExpressionType > > sinh () const
 
const SparseView< MatrixWrapper< ExpressionType > > sparseView (const Scalar &m_reference=Scalar(0), const typename NumTraits< Scalar >::Real &m_epsilon=NumTraits< Scalar >::dummy_precision()) const
 
const MatrixSquareRootReturnValue< MatrixWrapper< ExpressionType > > sqrt () const
 
EIGEN_DEVICE_FUNC RealScalar squaredNorm () const
 
RealScalar stableNorm () const
 
EIGEN_DEVICE_FUNC void stableNormalize ()
 
EIGEN_DEVICE_FUNC const PlainObject stableNormalized () const
 
EIGEN_DEVICE_FUNC Scalar trace () const
 
EIGEN_DEVICE_FUNC TriangularViewReturnType< Mode >::Type triangularView ()
 
EIGEN_DEVICE_FUNC ConstTriangularViewReturnType< Mode >::Type triangularView () const
 
EIGEN_DEVICE_FUNC const CwiseUnaryOp< CustomUnaryOp, const MatrixWrapper< ExpressionType > > unaryExpr (const CustomUnaryOp &func=CustomUnaryOp()) const
 Apply a unary operator coefficient-wise. More...
 
EIGEN_DEVICE_FUNC const CwiseUnaryView< CustomViewOp, const MatrixWrapper< ExpressionType > > unaryViewExpr (const CustomViewOp &func=CustomViewOp()) const
 
EIGEN_DEVICE_FUNC PlainObject unitOrthogonal (void) const
 
- Public Member Functions inherited from Eigen::DenseBase< Derived >
EIGEN_DEVICE_FUNC bool all () const
 
bool allFinite () const
 
EIGEN_DEVICE_FUNC bool any () const
 
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC BlockXpr block (Index startRow, Index startCol, Index blockRows, Index blockCols)
 
EIGEN_DEVICE_FUNC const ConstBlockXpr block (Index startRow, Index startCol, Index blockRows, Index blockCols) const
 This is the const version of block(Index,Index,Index,Index). */. More...
 
template<int NRows, int NCols>
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC FixedBlockXpr< NRows, NCols >::Type block (Index startRow, Index startCol)
 
template<int NRows, int NCols>
EIGEN_DEVICE_FUNC const ConstFixedBlockXpr< NRows, NCols >::Type block (Index startRow, Index startCol) const
 This is the const version of block<>(Index, Index). */. More...
 
template<int NRows, int NCols>
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL FixedBlockXpr< NRows, NCols >::Type block (Index startRow, Index startCol, Index blockRows, Index blockCols)
 
template<int NRows, int NCols>
const ConstFixedBlockXpr< NRows, NCols >::Type block (Index startRow, Index startCol, Index blockRows, Index blockCols) const
 This is the const version of block<>(Index, Index, Index, Index). More...
 
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC BlockXpr bottomLeftCorner (Index cRows, Index cCols)
 
EIGEN_DEVICE_FUNC const ConstBlockXpr bottomLeftCorner (Index cRows, Index cCols) const
 This is the const version of bottomLeftCorner(Index, Index). More...
 
template<int CRows, int CCols>
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC FixedBlockXpr< CRows, CCols >::Type bottomLeftCorner ()
 
template<int CRows, int CCols>
EIGEN_DEVICE_FUNC const ConstFixedBlockXpr< CRows, CCols >::Type bottomLeftCorner () const
 This is the const version of bottomLeftCorner<int, int>(). More...
 
template<int CRows, int CCols>
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL FixedBlockXpr< CRows, CCols >::Type bottomLeftCorner (Index cRows, Index cCols)
 
template<int CRows, int CCols>
const ConstFixedBlockXpr< CRows, CCols >::Type bottomLeftCorner (Index cRows, Index cCols) const
 This is the const version of bottomLeftCorner<int, int>(Index, Index). More...
 
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC BlockXpr bottomRightCorner (Index cRows, Index cCols)
 
EIGEN_DEVICE_FUNC const ConstBlockXpr bottomRightCorner (Index cRows, Index cCols) const
 This is the const version of bottomRightCorner(Index, Index). More...
 
template<int CRows, int CCols>
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC FixedBlockXpr< CRows, CCols >::Type bottomRightCorner ()
 
template<int CRows, int CCols>
EIGEN_DEVICE_FUNC const ConstFixedBlockXpr< CRows, CCols >::Type bottomRightCorner () const
 This is the const version of bottomRightCorner<int, int>(). More...
 
template<int CRows, int CCols>
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL FixedBlockXpr< CRows, CCols >::Type bottomRightCorner (Index cRows, Index cCols)
 
template<int CRows, int CCols>
const ConstFixedBlockXpr< CRows, CCols >::Type bottomRightCorner (Index cRows, Index cCols) const
 This is the const version of bottomRightCorner<int, int>(Index, Index). More...
 
EIGEN_DEVICE_FUNC RowsBlockXpr bottomRows (Index n)
 
EIGEN_DEVICE_FUNC ConstRowsBlockXpr bottomRows (Index n) const
 This is the const version of bottomRows(Index). More...
 
template<int N>
EIGEN_DEVICE_FUNC NRowsBlockXpr< N >::Type bottomRows (Index n=N)
 
template<int N>
EIGEN_DEVICE_FUNC ConstNRowsBlockXpr< N >::Type bottomRows (Index n=N) const
 This is the const version of bottomRows<int>(). More...
 
EIGEN_DEVICE_FUNC ColXpr col (Index i)
 
EIGEN_DEVICE_FUNC ConstColXpr col (Index i) const
 This is the const version of col(). More...
 
EIGEN_DEVICE_FUNC ConstColwiseReturnType colwise () const
 
EIGEN_DEVICE_FUNC ColwiseReturnType colwise ()
 
EIGEN_DEVICE_FUNC Index count () const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE EvalReturnType eval () const
 
template<typename Dest >
EIGEN_DEVICE_FUNC void evalTo (Dest &) const
 
EIGEN_DEVICE_FUNC void fill (const Scalar &value)
 
template<unsigned int Added, unsigned int Removed>
EIGEN_DEPRECATED const Derived & flagged () const
 
EIGEN_DEVICE_FUNC const ForceAlignedAccess< Derived > forceAlignedAccess () const
 
EIGEN_DEVICE_FUNC ForceAlignedAccess< Derived > forceAlignedAccess ()
 
template<bool Enable>
EIGEN_DEVICE_FUNC const internal::conditional< Enable, ForceAlignedAccess< Derived >, Derived & >::type forceAlignedAccessIf () const
 
template<bool Enable>
EIGEN_DEVICE_FUNC internal::conditional< Enable, ForceAlignedAccess< Derived >, Derived & >::type forceAlignedAccessIf ()
 
const WithFormat< Derived > format (const IOFormat &fmt) const
 
bool hasNaN () const
 
EIGEN_DEVICE_FUNC SegmentReturnType head (Index n)
 
EIGEN_DEVICE_FUNC ConstSegmentReturnType head (Index n) const
 This is the const version of head(Index). More...
 
template<int N>
EIGEN_DEVICE_FUNC FixedSegmentReturnType< N >::Type head (Index n=N)
 
template<int N>
EIGEN_DEVICE_FUNC ConstFixedSegmentReturnType< N >::Type head (Index n=N) const
 This is the const version of head<int>(). More...
 
EIGEN_DEVICE_FUNC Index innerSize () const
 
template<typename OtherDerived >
bool isApprox (const DenseBase< OtherDerived > &other, const RealScalar &prec) const
 
template<typename OtherDerived >
EIGEN_DEVICE_FUNC bool isApprox (const DenseBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const
 
EIGEN_DEVICE_FUNC bool isApproxToConstant (const Scalar &value, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const
 
EIGEN_DEVICE_FUNC 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
 
template<typename OtherDerived >
bool isMuchSmallerThan (const DenseBase< OtherDerived > &other, const RealScalar &prec) const
 
EIGEN_DEVICE_FUNC bool isMuchSmallerThan (const RealScalar &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const
 
template<typename OtherDerived >
EIGEN_DEVICE_FUNC bool isMuchSmallerThan (const DenseBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const
 
EIGEN_DEVICE_FUNC bool isOnes (const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const
 
EIGEN_DEVICE_FUNC bool isZero (const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const
 
template<typename OtherDerived >
EIGEN_STRONG_INLINE Derived & lazyAssign (const DenseBase< OtherDerived > &other)
 
template<typename OtherDerived >
EIGEN_DEVICE_FUNC Derived & lazyAssign (const DenseBase< OtherDerived > &other)
 
EIGEN_DEVICE_FUNC ColsBlockXpr leftCols (Index n)
 
EIGEN_DEVICE_FUNC ConstColsBlockXpr leftCols (Index n) const
 This is the const version of leftCols(Index). More...
 
template<int N>
EIGEN_DEVICE_FUNC NColsBlockXpr< N >::Type leftCols (Index n=N)
 
template<int N>
EIGEN_DEVICE_FUNC ConstNColsBlockXpr< N >::Type leftCols (Index n=N) const
 This is the const version of leftCols<int>(). More...
 
template<int p>
RealScalar lpNorm () const
 
EIGEN_DEVICE_FUNC internal::traits< Derived >::Scalar maxCoeff () const
 
template<typename IndexType >
EIGEN_DEVICE_FUNC internal::traits< Derived >::Scalar maxCoeff (IndexType *row, IndexType *col) const
 
template<typename IndexType >
EIGEN_DEVICE_FUNC internal::traits< Derived >::Scalar maxCoeff (IndexType *index) const
 
EIGEN_DEVICE_FUNC Scalar mean () const
 
EIGEN_DEVICE_FUNC ColsBlockXpr middleCols (Index startCol, Index numCols)
 
EIGEN_DEVICE_FUNC ConstColsBlockXpr middleCols (Index startCol, Index numCols) const
 This is the const version of middleCols(Index,Index). More...
 
template<int N>
EIGEN_DEVICE_FUNC NColsBlockXpr< N >::Type middleCols (Index startCol, Index n=N)
 
template<int N>
EIGEN_DEVICE_FUNC ConstNColsBlockXpr< N >::Type middleCols (Index startCol, Index n=N) const
 This is the const version of middleCols<int>(). More...
 
EIGEN_DEVICE_FUNC RowsBlockXpr middleRows (Index startRow, Index n)
 
EIGEN_DEVICE_FUNC ConstRowsBlockXpr middleRows (Index startRow, Index n) const
 This is the const version of middleRows(Index,Index). More...
 
template<int N>
EIGEN_DEVICE_FUNC NRowsBlockXpr< N >::Type middleRows (Index startRow, Index n=N)
 
template<int N>
EIGEN_DEVICE_FUNC ConstNRowsBlockXpr< N >::Type middleRows (Index startRow, Index n=N) const
 This is the const version of middleRows<int>(). More...
 
EIGEN_DEVICE_FUNC internal::traits< Derived >::Scalar minCoeff () const
 
template<typename IndexType >
EIGEN_DEVICE_FUNC internal::traits< Derived >::Scalar minCoeff (IndexType *row, IndexType *col) const
 
template<typename IndexType >
EIGEN_DEVICE_FUNC internal::traits< Derived >::Scalar minCoeff (IndexType *index) const
 
EIGEN_DEVICE_FUNC const NestByValue< Derived > nestByValue () const
 
EIGEN_DEVICE_FUNC Index nonZeros () const
 
template<typename CustomNullaryOp >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseNullaryOp< CustomNullaryOp, typename DenseBase< Derived >::PlainObjectNullaryExpr (Index rows, Index cols, const CustomNullaryOp &func)
 
template<typename CustomNullaryOp >
EIGEN_STRONG_INLINE const CwiseNullaryOp< CustomNullaryOp, typename DenseBase< Derived >::PlainObjectNullaryExpr (Index size, const CustomNullaryOp &func)
 
template<typename CustomNullaryOp >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseNullaryOp< CustomNullaryOp, typename DenseBase< Derived >::PlainObjectNullaryExpr (const CustomNullaryOp &func)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE Derived & operator*= (const Scalar &other)
 
template<typename OtherDerived >
EIGEN_DEVICE_FUNC Derived & operator+= (const EigenBase< OtherDerived > &other)
 
template<typename OtherDerived >
EIGEN_DEVICE_FUNC Derived & operator-= (const EigenBase< OtherDerived > &other)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE Derived & operator/= (const Scalar &other)
 
template<typename OtherDerived >
CommaInitializer< Derived > operator<< (const DenseBase< OtherDerived > &other)
 
EIGEN_DEVICE_FUNC CommaInitializer< Derived > operator<< (const Scalar &s)
 
template<typename OtherDerived >
EIGEN_DEVICE_FUNC CommaInitializer< Derived > operator<< (const DenseBase< OtherDerived > &other)
 
template<typename OtherDerived >
Derived & operator= (const ReturnByValue< OtherDerived > &other)
 
template<typename OtherDerived >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE Derived & operator= (const DenseBase< OtherDerived > &other)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE Derived & operator= (const DenseBase &other)
 
template<typename OtherDerived >
EIGEN_DEVICE_FUNC Derived & operator= (const EigenBase< OtherDerived > &other)
 Copies the generic expression other into *this. More...
 
template<typename OtherDerived >
EIGEN_DEVICE_FUNC Derived & operator= (const ReturnByValue< OtherDerived > &func)
 
EIGEN_DEVICE_FUNC Index outerSize () const
 
EIGEN_DEVICE_FUNC Scalar prod () const
 
template<typename Func >
internal::traits< Derived >::Scalar redux (const Func &func) const
 
template<typename BinaryOp >
EIGEN_DEVICE_FUNC Scalar redux (const BinaryOp &func) const
 
template<int RowFactor, int ColFactor>
const Replicate< Derived, RowFactor, ColFactor > replicate () const
 
template<int RowFactor, int ColFactor>
EIGEN_DEVICE_FUNC const Replicate< Derived, RowFactor, ColFactor > replicate () const
 
EIGEN_DEVICE_FUNC const Replicate< Derived, Dynamic, Dynamicreplicate (Index rowFactor, Index colFactor) const
 
EIGEN_DEVICE_FUNC void resize (Index newSize)
 
EIGEN_DEVICE_FUNC void resize (Index rows, Index cols)
 
EIGEN_DEVICE_FUNC ReverseReturnType reverse ()
 
EIGEN_DEVICE_FUNC ConstReverseReturnType reverse () const
 
EIGEN_DEVICE_FUNC void reverseInPlace ()
 
EIGEN_DEVICE_FUNC ColsBlockXpr rightCols (Index n)
 
EIGEN_DEVICE_FUNC ConstColsBlockXpr rightCols (Index n) const
 This is the const version of rightCols(Index). More...
 
template<int N>
EIGEN_DEVICE_FUNC NColsBlockXpr< N >::Type rightCols (Index n=N)
 
template<int N>
EIGEN_DEVICE_FUNC ConstNColsBlockXpr< N >::Type rightCols (Index n=N) const
 This is the const version of rightCols<int>(). More...
 
EIGEN_DEVICE_FUNC RowXpr row (Index i)
 
EIGEN_DEVICE_FUNC ConstRowXpr row (Index i) const
 This is the const version of row(). */. More...
 
EIGEN_DEVICE_FUNC ConstRowwiseReturnType rowwise () const
 
EIGEN_DEVICE_FUNC RowwiseReturnType rowwise ()
 
EIGEN_DEVICE_FUNC SegmentReturnType segment (Index start, Index n)
 
EIGEN_DEVICE_FUNC ConstSegmentReturnType segment (Index start, Index n) const
 This is the const version of segment(Index,Index). More...
 
template<int N>
EIGEN_DEVICE_FUNC FixedSegmentReturnType< N >::Type segment (Index start, Index n=N)
 
template<int N>
EIGEN_DEVICE_FUNC ConstFixedSegmentReturnType< N >::Type segment (Index start, Index n=N) const
 This is the const version of segment<int>(Index). More...
 
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
 
EIGEN_DEVICE_FUNC Derived & setConstant (const Scalar &value)
 
EIGEN_DEVICE_FUNC Derived & setLinSpaced (Index size, const Scalar &low, const Scalar &high)
 Sets a linearly spaced vector. More...
 
EIGEN_DEVICE_FUNC Derived & setLinSpaced (const Scalar &low, const Scalar &high)
 Sets a linearly spaced vector. More...
 
EIGEN_DEVICE_FUNC Derived & setOnes ()
 
EIGEN_DEVICE_FUNC Derived & setRandom ()
 
EIGEN_DEVICE_FUNC Derived & setZero ()
 
EIGEN_DEVICE_FUNC Scalar sum () const
 
template<typename OtherDerived >
EIGEN_DEVICE_FUNC void swap (const DenseBase< OtherDerived > &other)
 
template<typename OtherDerived >
EIGEN_DEVICE_FUNC void swap (PlainObjectBase< OtherDerived > &other)
 
EIGEN_DEVICE_FUNC SegmentReturnType tail (Index n)
 
EIGEN_DEVICE_FUNC ConstSegmentReturnType tail (Index n) const
 This is the const version of tail(Index). More...
 
template<int N>
EIGEN_DEVICE_FUNC FixedSegmentReturnType< N >::Type tail (Index n=N)
 
template<int N>
EIGEN_DEVICE_FUNC ConstFixedSegmentReturnType< N >::Type tail (Index n=N) const
 This is the const version of tail<int>. More...
 
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC BlockXpr topLeftCorner (Index cRows, Index cCols)
 
EIGEN_DEVICE_FUNC const ConstBlockXpr topLeftCorner (Index cRows, Index cCols) const
 This is the const version of topLeftCorner(Index, Index). More...
 
template<int CRows, int CCols>
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC FixedBlockXpr< CRows, CCols >::Type topLeftCorner ()
 
template<int CRows, int CCols>
EIGEN_DEVICE_FUNC const ConstFixedBlockXpr< CRows, CCols >::Type topLeftCorner () const
 This is the const version of topLeftCorner<int, int>(). More...
 
template<int CRows, int CCols>
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL FixedBlockXpr< CRows, CCols >::Type topLeftCorner (Index cRows, Index cCols)
 
template<int CRows, int CCols>
const ConstFixedBlockXpr< CRows, CCols >::Type topLeftCorner (Index cRows, Index cCols) const
 This is the const version of topLeftCorner<int, int>(Index, Index). More...
 
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC BlockXpr topRightCorner (Index cRows, Index cCols)
 
EIGEN_DEVICE_FUNC const ConstBlockXpr topRightCorner (Index cRows, Index cCols) const
 This is the const version of topRightCorner(Index, Index). More...
 
template<int CRows, int CCols>
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC FixedBlockXpr< CRows, CCols >::Type topRightCorner ()
 
template<int CRows, int CCols>
EIGEN_DEVICE_FUNC const ConstFixedBlockXpr< CRows, CCols >::Type topRightCorner () const
 This is the const version of topRightCorner<int, int>(). More...
 
template<int CRows, int CCols>
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL FixedBlockXpr< CRows, CCols >::Type topRightCorner (Index cRows, Index cCols)
 
template<int CRows, int CCols>
const ConstFixedBlockXpr< CRows, CCols >::Type topRightCorner (Index cRows, Index cCols) const
 This is the const version of topRightCorner<int, int>(Index, Index). More...
 
EIGEN_DEVICE_FUNC RowsBlockXpr topRows (Index n)
 
EIGEN_DEVICE_FUNC ConstRowsBlockXpr topRows (Index n) const
 This is the const version of topRows(Index). More...
 
template<int N>
EIGEN_DEVICE_FUNC NRowsBlockXpr< N >::Type topRows (Index n=N)
 
template<int N>
EIGEN_DEVICE_FUNC ConstNRowsBlockXpr< N >::Type topRows (Index n=N) const
 This is the const version of topRows<int>(). More...
 
EIGEN_DEVICE_FUNC Scalar trace () const
 
EIGEN_DEVICE_FUNC TransposeReturnType transpose ()
 
EIGEN_DEVICE_FUNC ConstTransposeReturnType transpose () const
 
EIGEN_DEVICE_FUNC void transposeInPlace ()
 
EIGEN_DEVICE_FUNC CoeffReturnType value () const
 
template<typename Visitor >
EIGEN_DEVICE_FUNC void visit (Visitor &func) const
 

Protected Attributes

NestedExpressionType m_expression
 

Additional Inherited Members

- Static Public Member Functions inherited from Eigen::MatrixBase< MatrixWrapper< ExpressionType > >
static EIGEN_DEVICE_FUNC const IdentityReturnType Identity ()
 
static EIGEN_DEVICE_FUNC const IdentityReturnType Identity (Index rows, Index cols)
 
static EIGEN_DEVICE_FUNC const BasisReturnType Unit (Index size, Index i)
 
static EIGEN_DEVICE_FUNC const BasisReturnType Unit (Index i)
 
static EIGEN_DEVICE_FUNC const BasisReturnType UnitW ()
 
static EIGEN_DEVICE_FUNC const BasisReturnType UnitX ()
 
static EIGEN_DEVICE_FUNC const BasisReturnType UnitY ()
 
static EIGEN_DEVICE_FUNC const BasisReturnType UnitZ ()
 
- Static Public Member Functions inherited from Eigen::DenseBase< Derived >
static EIGEN_DEVICE_FUNC const ConstantReturnType Constant (Index rows, Index cols, const Scalar &value)
 
static EIGEN_DEVICE_FUNC const ConstantReturnType Constant (Index size, const Scalar &value)
 
static EIGEN_DEVICE_FUNC const ConstantReturnType Constant (const Scalar &value)
 
static EIGEN_DEVICE_FUNC const SequentialLinSpacedReturnType LinSpaced (Sequential_t, Index size, const Scalar &low, const Scalar &high)
 
static EIGEN_DEVICE_FUNC const RandomAccessLinSpacedReturnType LinSpaced (Index size, const Scalar &low, const Scalar &high)
 Sets a linearly spaced vector. More...
 
static EIGEN_DEVICE_FUNC const SequentialLinSpacedReturnType LinSpaced (Sequential_t, const Scalar &low, const Scalar &high)
 
static EIGEN_DEVICE_FUNC const RandomAccessLinSpacedReturnType LinSpaced (const Scalar &low, const Scalar &high)
 Sets a linearly spaced vector. More...
 
template<typename CustomNullaryOp >
static EIGEN_DEVICE_FUNC const CwiseNullaryOp< CustomNullaryOp, PlainObjectNullaryExpr (Index rows, Index cols, const CustomNullaryOp &func)
 
template<typename CustomNullaryOp >
static EIGEN_DEVICE_FUNC const CwiseNullaryOp< CustomNullaryOp, PlainObjectNullaryExpr (Index size, const CustomNullaryOp &func)
 
template<typename CustomNullaryOp >
static EIGEN_DEVICE_FUNC const CwiseNullaryOp< CustomNullaryOp, PlainObjectNullaryExpr (const CustomNullaryOp &func)
 
static EIGEN_DEVICE_FUNC const ConstantReturnType Ones (Index rows, Index cols)
 
static EIGEN_DEVICE_FUNC const ConstantReturnType Ones (Index size)
 
static EIGEN_DEVICE_FUNC const ConstantReturnType Ones ()
 
static const RandomReturnType Random (Index rows, Index cols)
 
static const RandomReturnType Random (Index size)
 
static const RandomReturnType Random ()
 
static EIGEN_DEVICE_FUNC const ConstantReturnType Zero (Index rows, Index cols)
 
static EIGEN_DEVICE_FUNC const ConstantReturnType Zero (Index size)
 
static EIGEN_DEVICE_FUNC const ConstantReturnType Zero ()
 
- Protected Member Functions inherited from Eigen::MatrixBase< MatrixWrapper< ExpressionType > >
EIGEN_DEVICE_FUNC MatrixBase ()
 
MatrixWrapper< ExpressionType > & operator+= (const ArrayBase< OtherDerived > &)
 
MatrixWrapper< ExpressionType > & operator-= (const ArrayBase< OtherDerived > &)
 
- Protected Member Functions inherited from Eigen::DenseBase< Derived >
EIGEN_DEVICE_FUNC DenseBase ()
 

Detailed Description

template<typename ExpressionType>
class Eigen::MatrixWrapper< ExpressionType >

Expression of an array as a mathematical vector or matrix.

This class is the return type of ArrayBase::matrix(), and most of the time this is the only way it is use.

See also
MatrixBase::matrix(), class ArrayWrapper

Definition at line 15 of file ArrayBase.h.

Member Typedef Documentation

template<typename ExpressionType >
typedef MatrixBase<MatrixWrapper<ExpressionType> > Eigen::MatrixWrapper< ExpressionType >::Base

Definition at line 143 of file ArrayWrapper.h.

template<typename ExpressionType >
typedef internal::remove_all<ExpressionType>::type Eigen::MatrixWrapper< ExpressionType >::NestedExpression

Definition at line 146 of file ArrayWrapper.h.

template<typename ExpressionType >
typedef internal::ref_selector<ExpressionType>::non_const_type Eigen::MatrixWrapper< ExpressionType >::NestedExpressionType

Definition at line 154 of file ArrayWrapper.h.

template<typename ExpressionType >
typedef internal::conditional< internal::is_lvalue<ExpressionType>::value, Scalar, const Scalar >::type Eigen::MatrixWrapper< ExpressionType >::ScalarWithConstIfNotLvalue

Definition at line 152 of file ArrayWrapper.h.

Constructor & Destructor Documentation

template<typename ExpressionType >
EIGEN_DEVICE_FUNC Eigen::MatrixWrapper< ExpressionType >::MatrixWrapper ( ExpressionType &  matrix)
inlineexplicit

Definition at line 159 of file ArrayWrapper.h.

Member Function Documentation

template<typename ExpressionType >
EIGEN_DEVICE_FUNC const Scalar& Eigen::MatrixWrapper< ExpressionType >::coeffRef ( Index  rowId,
Index  colId 
) const
inline

Definition at line 176 of file ArrayWrapper.h.

template<typename ExpressionType >
EIGEN_DEVICE_FUNC const Scalar& Eigen::MatrixWrapper< ExpressionType >::coeffRef ( Index  index) const
inline

Definition at line 182 of file ArrayWrapper.h.

template<typename ExpressionType >
EIGEN_DEVICE_FUNC Index Eigen::MatrixWrapper< ExpressionType >::cols ( ) const
inline

Definition at line 164 of file ArrayWrapper.h.

template<typename ExpressionType >
EIGEN_DEVICE_FUNC ScalarWithConstIfNotLvalue* Eigen::MatrixWrapper< ExpressionType >::data ( )
inline

Definition at line 171 of file ArrayWrapper.h.

template<typename ExpressionType >
EIGEN_DEVICE_FUNC const Scalar* Eigen::MatrixWrapper< ExpressionType >::data ( ) const
inline

Definition at line 173 of file ArrayWrapper.h.

template<typename ExpressionType >
EIGEN_DEVICE_FUNC Index Eigen::MatrixWrapper< ExpressionType >::innerStride ( ) const
inline

Definition at line 168 of file ArrayWrapper.h.

template<typename ExpressionType >
EIGEN_DEVICE_FUNC const internal::remove_all<NestedExpressionType>::type& Eigen::MatrixWrapper< ExpressionType >::nestedExpression ( ) const
inline

Definition at line 189 of file ArrayWrapper.h.

template<typename ExpressionType >
EIGEN_DEVICE_FUNC Index Eigen::MatrixWrapper< ExpressionType >::outerStride ( ) const
inline

Definition at line 166 of file ArrayWrapper.h.

template<typename ExpressionType >
EIGEN_DEVICE_FUNC void Eigen::MatrixWrapper< ExpressionType >::resize ( Index  newSize)
inline

Forwards the resizing request to the nested expression

See also
DenseBase::resize(Index)

Definition at line 197 of file ArrayWrapper.h.

template<typename ExpressionType >
EIGEN_DEVICE_FUNC void Eigen::MatrixWrapper< ExpressionType >::resize ( Index  rows,
Index  cols 
)
inline

Forwards the resizing request to the nested expression

See also
DenseBase::resize(Index,Index)

Definition at line 201 of file ArrayWrapper.h.

template<typename ExpressionType >
EIGEN_DEVICE_FUNC Index Eigen::MatrixWrapper< ExpressionType >::rows ( ) const
inline

Definition at line 162 of file ArrayWrapper.h.

Member Data Documentation

template<typename ExpressionType >
NestedExpressionType Eigen::MatrixWrapper< ExpressionType >::m_expression
protected

Definition at line 204 of file ArrayWrapper.h.


The documentation for this class was generated from the following files:


hebiros
Author(s): Xavier Artache , Matthew Tesch
autogenerated on Thu Sep 3 2020 04:10:11