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

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

#include <ArrayWrapper.h>

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

Public Types

typedef ArrayBase< ArrayWrapperBase
 
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::ArrayBase< ArrayWrapper< ExpressionType > >
typedef CwiseUnaryOp< internal::scalar_abs2_op< Scalar >, const ArrayWrapper< ExpressionType > > Abs2ReturnType
 
typedef CwiseUnaryOp< internal::scalar_abs_op< Scalar >, const ArrayWrapper< ExpressionType > > AbsReturnType
 
typedef CwiseUnaryOp< internal::scalar_acos_op< Scalar >, const ArrayWrapper< ExpressionType > > AcosReturnType
 
typedef CwiseUnaryOp< internal::scalar_arg_op< Scalar >, const ArrayWrapper< ExpressionType > > ArgReturnType
 
typedef CwiseUnaryOp< internal::scalar_asin_op< Scalar >, const ArrayWrapper< ExpressionType > > AsinReturnType
 
typedef CwiseUnaryOp< internal::scalar_atan_op< Scalar >, const ArrayWrapper< ExpressionType > > AtanReturnType
 
typedef DenseBase< ArrayWrapper< ExpressionType > > Base
 
typedef CwiseUnaryOp< internal::scalar_boolean_not_op< Scalar >, const ArrayWrapper< ExpressionType > > BooleanNotReturnType
 
typedef CwiseUnaryOp< internal::scalar_ceil_op< Scalar >, const ArrayWrapper< ExpressionType > > CeilReturnType
 
typedef Base::CoeffReturnType CoeffReturnType
 
typedef CwiseNullaryOp< internal::scalar_constant_op< Scalar >, PlainObjectConstantReturnType
 
typedef CwiseUnaryOp< internal::scalar_cosh_op< Scalar >, const ArrayWrapper< ExpressionType > > CoshReturnType
 
typedef CwiseUnaryOp< internal::scalar_cos_op< Scalar >, const ArrayWrapper< ExpressionType > > CosReturnType
 
typedef CwiseUnaryOp< internal::scalar_cube_op< Scalar >, const ArrayWrapper< ExpressionType > > CubeReturnType
 
typedef CwiseUnaryOp< internal::scalar_abs2_op< Scalar >, const ArrayWrapper< ExpressionType > > CwiseAbs2ReturnType
 
typedef CwiseUnaryOp< internal::scalar_abs_op< Scalar >, const ArrayWrapper< ExpressionType > > CwiseAbsReturnType
 
typedef CwiseUnaryOp< internal::scalar_arg_op< Scalar >, const ArrayWrapper< ExpressionType > > CwiseArgReturnType
 
typedef CwiseUnaryOp< internal::scalar_inverse_op< Scalar >, const ArrayWrapper< ExpressionType > > CwiseInverseReturnType
 
typedef CwiseBinaryOp< internal::scalar_cmp_op< Scalar, Scalar, internal::cmp_EQ >, const ArrayWrapper< ExpressionType >, const ConstantReturnTypeCwiseScalarEqualReturnType
 
typedef CwiseUnaryOp< internal::scalar_sign_op< Scalar >, const ArrayWrapper< ExpressionType > > CwiseSignReturnType
 
typedef CwiseUnaryOp< internal::scalar_sqrt_op< Scalar >, const ArrayWrapper< ExpressionType > > CwiseSqrtReturnType
 
typedef CwiseUnaryOp< internal::scalar_digamma_op< Scalar >, const ArrayWrapper< ExpressionType > > DigammaReturnType
 
typedef ArrayBase Eigen_BaseClassForSpecializationOfGlobalMathFuncImpl
 
typedef CwiseUnaryOp< internal::scalar_erfc_op< Scalar >, const ArrayWrapper< ExpressionType > > ErfcReturnType
 
typedef CwiseUnaryOp< internal::scalar_erf_op< Scalar >, const ArrayWrapper< ExpressionType > > ErfReturnType
 
typedef CwiseUnaryOp< internal::scalar_expm1_op< Scalar >, const ArrayWrapper< ExpressionType > > Expm1ReturnType
 
typedef CwiseUnaryOp< internal::scalar_exp_op< Scalar >, const ArrayWrapper< ExpressionType > > ExpReturnType
 
typedef CwiseUnaryOp< internal::scalar_floor_op< Scalar >, const ArrayWrapper< ExpressionType > > FloorReturnType
 
typedef CwiseUnaryOp< internal::scalar_inverse_op< Scalar >, const ArrayWrapper< ExpressionType > > InverseReturnType
 
typedef CwiseUnaryOp< internal::scalar_isfinite_op< Scalar >, const ArrayWrapper< ExpressionType > > IsFiniteReturnType
 
typedef CwiseUnaryOp< internal::scalar_isinf_op< Scalar >, const ArrayWrapper< ExpressionType > > IsInfReturnType
 
typedef CwiseUnaryOp< internal::scalar_isnan_op< Scalar >, const ArrayWrapper< ExpressionType > > IsNaNReturnType
 
typedef CwiseUnaryOp< internal::scalar_lgamma_op< Scalar >, const ArrayWrapper< ExpressionType > > LgammaReturnType
 
typedef CwiseUnaryOp< internal::scalar_log10_op< Scalar >, const ArrayWrapper< ExpressionType > > Log10ReturnType
 
typedef CwiseUnaryOp< internal::scalar_log1p_op< Scalar >, const ArrayWrapper< ExpressionType > > Log1pReturnType
 
typedef CwiseUnaryOp< internal::scalar_log2_op< Scalar >, const ArrayWrapper< ExpressionType > > Log2ReturnType
 
typedef CwiseUnaryOp< internal::scalar_logistic_op< Scalar >, const ArrayWrapper< ExpressionType > > LogisticReturnType
 
typedef CwiseUnaryOp< internal::scalar_log_op< Scalar >, const ArrayWrapper< ExpressionType > > LogReturnType
 
typedef CwiseUnaryOp< internal::scalar_ndtri_op< Scalar >, const ArrayWrapper< ExpressionType > > NdtriReturnType
 
typedef internal::packet_traits< Scalar >::type PacketScalar
 
typedef Base::PlainObject PlainObject
 
typedef NumTraits< Scalar >::Real RealScalar
 
typedef CwiseUnaryOp< internal::scalar_rint_op< Scalar >, const ArrayWrapper< ExpressionType > > RintReturnType
 
typedef CwiseUnaryOp< internal::scalar_round_op< Scalar >, const ArrayWrapper< ExpressionType > > RoundReturnType
 
typedef CwiseUnaryOp< internal::scalar_rsqrt_op< Scalar >, const ArrayWrapper< ExpressionType > > RsqrtReturnType
 
typedef internal::traits< ArrayWrapper< ExpressionType > >::Scalar Scalar
 
typedef CwiseUnaryOp< internal::scalar_sign_op< Scalar >, const ArrayWrapper< ExpressionType > > SignReturnType
 
typedef CwiseUnaryOp< internal::scalar_sinh_op< Scalar >, const ArrayWrapper< ExpressionType > > SinhReturnType
 
typedef CwiseUnaryOp< internal::scalar_sin_op< Scalar >, const ArrayWrapper< ExpressionType > > SinReturnType
 
typedef CwiseUnaryOp< internal::scalar_sqrt_op< Scalar >, const ArrayWrapper< ExpressionType > > SqrtReturnType
 
typedef CwiseUnaryOp< internal::scalar_square_op< Scalar >, const ArrayWrapper< ExpressionType > > SquareReturnType
 
typedef ArrayBase StorageBaseType
 
typedef internal::traits< ArrayWrapper< ExpressionType > >::StorageKind StorageKind
 
typedef CwiseUnaryOp< internal::scalar_tanh_op< Scalar >, const ArrayWrapper< ExpressionType > > TanhReturnType
 
typedef CwiseUnaryOp< internal::scalar_tan_op< Scalar >, const ArrayWrapper< ExpressionType > > TanReturnType
 
- 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, NumDimensions = int(MaxSizeAtCompileTime) == 1 ? 0 : bool(IsVectorAtCompileTime) ? 1 : 2,
  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, internal::accessors_level< Derived >::valueBase
 
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 internal::conditional< NumTraits< Scalar >::IsComplex, const CwiseUnaryOp< internal::scalar_conjugate_op< Scalar >, const Derived >, const Derived &>::type ConjugateReturnType
 
typedef internal::conditional< IsVectorAtCompileTime, const_iterator_type, void >::type const_iterator
 
typedef internal::conditional<(Flags &DirectAccessBit)==DirectAccessBit, internal::pointer_based_stl_iterator< const Derived >, internal::generic_randaccess_stl_iterator< const Derived > >::type const_iterator_type
 
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 Block< const Derived, IsRowMajor?1:Dynamic, IsRowMajor?Dynamic:1, true > ConstInnerVectorReturnType
 
typedef Block< const Derived, Dynamic, Dynamic, true > ConstInnerVectorsReturnType
 
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 CwiseUnaryOp< internal::scalar_imag_op< Scalar >, const Derived > ImagReturnType
 
typedef Eigen::InnerIterator< Derived > InnerIterator
 
typedef Block< Derived, IsRowMajor?1:Dynamic, IsRowMajor?Dynamic:1, true > InnerVectorReturnType
 
typedef Block< Derived, Dynamic, Dynamic, true > InnerVectorsReturnType
 
typedef internal::conditional< IsVectorAtCompileTime, iterator_type, void >::type iterator
 
typedef internal::conditional<(Flags &DirectAccessBit)==DirectAccessBit, internal::pointer_based_stl_iterator< Derived >, internal::generic_randaccess_stl_iterator< Derived > >::type iterator_type
 
typedef CwiseUnaryOp< internal::scalar_opposite_op< Scalar >, const Derived > NegativeReturnType
 
typedef CwiseUnaryView< internal::scalar_imag_ref_op< Scalar >, Derived > NonConstImagReturnType
 
typedef internal::conditional< NumTraits< Scalar >::IsComplex, CwiseUnaryView< internal::scalar_real_ref_op< Scalar >, Derived >, Derived &>::type NonConstRealReturnType
 
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 >, PlainObjectRandomAccessLinSpacedReturnType
 
typedef CwiseNullaryOp< internal::scalar_random_op< Scalar >, PlainObjectRandomReturnType
 
typedef internal::conditional< NumTraits< Scalar >::IsComplex, const CwiseUnaryOp< internal::scalar_real_op< Scalar >, const Derived >, const Derived &>::type RealReturnType
 
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 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 EIGEN_STRONG_INLINE ArrayWrapper (ExpressionType &matrix)
 
EIGEN_DEVICE_FUNC const ScalarcoeffRef (Index rowId, Index colId) const
 
EIGEN_DEVICE_FUNC const ScalarcoeffRef (Index index) const
 
EIGEN_DEVICE_FUNC EIGEN_CONSTEXPR Index cols () const EIGEN_NOEXCEPT
 
EIGEN_DEVICE_FUNC ScalarWithConstIfNotLvaluedata ()
 
EIGEN_DEVICE_FUNC const Scalardata () const
 
template<typename Dest >
EIGEN_DEVICE_FUNC void evalTo (Dest &dst) const
 
EIGEN_DEVICE_FUNC EIGEN_CONSTEXPR Index innerStride () const EIGEN_NOEXCEPT
 
EIGEN_DEVICE_FUNC const internal::remove_all< NestedExpressionType >::typenestedExpression () const
 
EIGEN_DEVICE_FUNC EIGEN_CONSTEXPR Index outerStride () const EIGEN_NOEXCEPT
 
EIGEN_DEVICE_FUNC void resize (Index newSize)
 
EIGEN_DEVICE_FUNC void resize (Index rows, Index cols)
 
EIGEN_DEVICE_FUNC EIGEN_CONSTEXPR Index rows () const EIGEN_NOEXCEPT
 
- Public Member Functions inherited from Eigen::ArrayBase< ArrayWrapper< ExpressionType > >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const AbsReturnType abs () const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const Abs2ReturnType abs2 () const
 
EIGEN_DEVICE_FUNC const AcosReturnType acos () const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ArgReturnType arg () const
 
EIGEN_DEVICE_FUNC ArrayBase< ArrayWrapper< ExpressionType > > & array ()
 
EIGEN_DEVICE_FUNC const ArrayBase< ArrayWrapper< ExpressionType > > & array () const
 
EIGEN_DEVICE_FUNC const AsinReturnType asin () const
 
EIGEN_DEVICE_FUNC const AtanReturnType atan () const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseBinaryOp< CustomBinaryOp, const ArrayWrapper< ExpressionType >, const OtherDerived > binaryExpr (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other, const CustomBinaryOp &func=CustomBinaryOp()) const
 
EIGEN_DEVICE_FUNC const CeilReturnType ceil () const
 
EIGEN_DEVICE_FUNC const CosReturnType cos () const
 
EIGEN_DEVICE_FUNC const CoshReturnType cosh () const
 
EIGEN_DEVICE_FUNC const CubeReturnType cube () 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 CwiseArgReturnType cwiseArg () const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseBinaryOp (min)(const Scalar &other) const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseBinaryOp (max)(const Scalar &other) const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseBinaryOp (absolute_difference)(const Scalar &other) const
 
EIGEN_DEVICE_FUNC const CwiseBinaryOp< numext::equal_to< Scalar >, const ArrayWrapper< 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 ArrayWrapper< 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 ArrayWrapper< ExpressionType >, const ConstantReturnTypecwiseMax (const Scalar &other) const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_min_op< Scalar, Scalar >, const ArrayWrapper< 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 ArrayWrapper< ExpressionType >, const ConstantReturnTypecwiseMin (const Scalar &other) const
 
EIGEN_DEVICE_FUNC const CwiseBinaryOp< numext::not_equal_to< Scalar >, const ArrayWrapper< ExpressionType >, const OtherDerived > cwiseNotEqual (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_quotient_op< Scalar >, const ArrayWrapper< 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
 
EIGEN_DEVICE_FUNC const DigammaReturnType digamma () const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const EIGEN_CWISE_BINARY_RETURN_TYPE (ArrayWrapper< ExpressionType >, OtherDerived, product) operator*(const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const EIGEN_CWISE_BINARY_RETURN_TYPE (ArrayWrapper< ExpressionType >, OtherDerived, product) cwiseProduct(const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
EIGEN_DEVICE_FUNC const ErfReturnType erf () const
 
EIGEN_DEVICE_FUNC const ErfcReturnType erfc () const
 
EIGEN_DEVICE_FUNC const ExpReturnType exp () const
 
EIGEN_DEVICE_FUNC const Expm1ReturnType expm1 () const
 
EIGEN_DEVICE_FUNC const FloorReturnType floor () const
 
EIGEN_DEVICE_FUNC const InverseReturnType inverse () const
 
EIGEN_DEVICE_FUNC const IsFiniteReturnType isFinite () const
 
EIGEN_DEVICE_FUNC const IsInfReturnType isInf () const
 
EIGEN_DEVICE_FUNC const IsNaNReturnType isNaN () const
 
EIGEN_DEVICE_FUNC const LgammaReturnType lgamma () const
 
EIGEN_DEVICE_FUNC const LogReturnType log () const
 
EIGEN_DEVICE_FUNC const Log10ReturnType log10 () const
 
EIGEN_DEVICE_FUNC const Log1pReturnType log1p () const
 
EIGEN_DEVICE_FUNC const Log2ReturnType log2 () const
 
EIGEN_DEVICE_FUNC const LogisticReturnType logistic () const
 
EIGEN_DEVICE_FUNC MatrixWrapper< ArrayWrapper< ExpressionType > > matrix ()
 
EIGEN_DEVICE_FUNC const MatrixWrapper< const ArrayWrapper< ExpressionType > > matrix () const
 
EIGEN_DEVICE_FUNC const NdtriReturnType ndtri () const
 
EIGEN_DEVICE_FUNC const BooleanNotReturnType operator! () const
 
EIGEN_DEVICE_FUNC const CwiseBinaryOp< internal::scalar_boolean_and_op, const ArrayWrapper< ExpressionType >, const OtherDerived > operator&& (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ArrayWrapper< ExpressionType > & operator*= (const ArrayBase< OtherDerived > &other)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ArrayWrapper< ExpressionType > & operator+= (const Scalar &scalar)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ArrayWrapper< ExpressionType > & operator+= (const ArrayBase< OtherDerived > &other)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ArrayWrapper< ExpressionType > & operator-= (const Scalar &scalar)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ArrayWrapper< ExpressionType > & operator-= (const ArrayBase< OtherDerived > &other)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_quotient_op< Scalar, typename OtherDerived::Scalar >, const ArrayWrapper< ExpressionType >, const OtherDerived > operator/ (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ArrayWrapper< ExpressionType > & operator/= (const ArrayBase< OtherDerived > &other)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ArrayWrapper< ExpressionType > & operator= (const ArrayBase &other)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ArrayWrapper< ExpressionType > & operator= (const Scalar &value)
 
EIGEN_DEVICE_FUNC const CwiseBinaryOp< internal::scalar_boolean_xor_op, const ArrayWrapper< ExpressionType >, const OtherDerived > operator^ (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
EIGEN_DEVICE_FUNC const CwiseBinaryOp< internal::scalar_boolean_or_op, const ArrayWrapper< ExpressionType >, const OtherDerived > operator|| (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
EIGEN_DEVICE_FUNC const RintReturnType rint () const
 
EIGEN_DEVICE_FUNC const RoundReturnType round () const
 
EIGEN_DEVICE_FUNC const RsqrtReturnType rsqrt () const
 
EIGEN_DEVICE_FUNC ShiftLeftXpr< N >::Type shiftLeft () const
 
EIGEN_DEVICE_FUNC ShiftRightXpr< N >::Type shiftRight () const
 
EIGEN_DEVICE_FUNC const SignReturnType sign () const
 
EIGEN_DEVICE_FUNC const SinReturnType sin () const
 
EIGEN_DEVICE_FUNC const SinhReturnType sinh () const
 
EIGEN_DEVICE_FUNC const SqrtReturnType sqrt () const
 
EIGEN_DEVICE_FUNC const SquareReturnType square () const
 
EIGEN_DEVICE_FUNC const TanReturnType tan () const
 
EIGEN_DEVICE_FUNC const TanhReturnType tanh () const
 
const CwiseBinaryOp< internal::scalar_zeta_op< Scalar >, const ArrayWrapper< ExpressionType >, const DerivedQ > zeta (const EIGEN_CURRENT_STORAGE_BASE_CLASS< DerivedQ > &q) const
 
- Public Member Functions inherited from Eigen::DenseBase< Derived >
EIGEN_DEVICE_FUNC bool all () const
 
bool allFinite () const
 
EIGEN_DEVICE_FUNC bool any () const
 
iterator begin ()
 
const_iterator begin () const
 
template<typename NRowsType , typename NColsType >
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedBlockXpr< internal::get_fixed_value< NRowsType >::value, internal::get_fixed_value< NColsType >::value >::Type block (Index startRow, Index startCol, NRowsType blockRows, NColsType blockCols)
 
template<typename NRowsType , typename NColsType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ConstFixedBlockXpr< internal::get_fixed_value< NRowsType >::value, internal::get_fixed_value< NColsType >::value >::Type block (Index startRow, Index startCol, NRowsType blockRows, NColsType blockCols) const
 This is the const version of block(Index,Index,NRowsType,NColsType) More...
 
template<int NRows, int NCols>
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedBlockXpr< NRows, NCols >::Type block (Index startRow, Index startCol)
 
template<int NRows, int NCols>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE 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 EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedBlockXpr< NRows, NCols >::Type block (Index startRow, Index startCol, Index blockRows, Index blockCols)
 
template<int NRows, int NCols>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE 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...
 
template<typename NRowsType , typename NColsType >
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedBlockXpr< internal::get_fixed_value< NRowsType >::value, internal::get_fixed_value< NColsType >::value >::Type bottomLeftCorner (NRowsType cRows, NColsType cCols)
 
template<typename NRowsType , typename NColsType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ConstFixedBlockXpr< internal::get_fixed_value< NRowsType >::value, internal::get_fixed_value< NColsType >::value >::Type bottomLeftCorner (NRowsType cRows, NColsType cCols) const
 This is the const version of bottomLeftCorner(NRowsType, NColsType). More...
 
template<int CRows, int CCols>
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedBlockXpr< CRows, CCols >::Type bottomLeftCorner ()
 
template<int CRows, int CCols>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE 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 EIGEN_STRONG_INLINE FixedBlockXpr< CRows, CCols >::Type bottomLeftCorner (Index cRows, Index cCols)
 
template<int CRows, int CCols>
EIGEN_STRONG_INLINE const ConstFixedBlockXpr< CRows, CCols >::Type bottomLeftCorner (Index cRows, Index cCols) const
 This is the const version of bottomLeftCorner<int, int>(Index, Index). More...
 
template<typename NRowsType , typename NColsType >
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedBlockXpr< internal::get_fixed_value< NRowsType >::value, internal::get_fixed_value< NColsType >::value >::Type bottomRightCorner (NRowsType cRows, NColsType cCols)
 
template<typename NRowsType , typename NColsType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ConstFixedBlockXpr< internal::get_fixed_value< NRowsType >::value, internal::get_fixed_value< NColsType >::value >::Type bottomRightCorner (NRowsType cRows, NColsType cCols) const
 This is the const version of bottomRightCorner(NRowsType, NColsType). More...
 
template<int CRows, int CCols>
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedBlockXpr< CRows, CCols >::Type bottomRightCorner ()
 
template<int CRows, int CCols>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE 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 EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedBlockXpr< CRows, CCols >::Type bottomRightCorner (Index cRows, Index cCols)
 
template<int CRows, int CCols>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ConstFixedBlockXpr< CRows, CCols >::Type bottomRightCorner (Index cRows, Index cCols) const
 This is the const version of bottomRightCorner<int, int>(Index, Index). More...
 
template<typename NRowsType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NRowsBlockXpr< internal::get_fixed_value< NRowsType >::value >::Type bottomRows (NRowsType n)
 
template<typename NRowsType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ConstNRowsBlockXpr< internal::get_fixed_value< NRowsType >::value >::Type bottomRows (NRowsType n) const
 This is the const version of bottomRows(NRowsType). More...
 
template<int N>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NRowsBlockXpr< N >::Type bottomRows (Index n=N)
 
template<int N>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ConstNRowsBlockXpr< N >::Type bottomRows (Index n=N) const
 This is the const version of bottomRows<int>(). More...
 
template<typename NewType >
EIGEN_DEVICE_FUNC CastXpr< NewType >::Type cast () const
 
const_iterator cbegin () const
 
const_iterator cend () const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ColXpr col (Index i)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE 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 ConjugateReturnType conjugate () const
 
template<bool Cond>
EIGEN_DEVICE_FUNC internal::conditional< Cond, ConjugateReturnType, const Derived & >::type conjugateIf () const
 
EIGEN_DEVICE_FUNC Index count () const
 
iterator end ()
 
const_iterator end () 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
 
template<typename NType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedSegmentReturnType< internal::get_fixed_value< NType >::value >::Type head (NType n)
 
template<typename NType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ConstFixedSegmentReturnType< internal::get_fixed_value< NType >::value >::Type head (NType n) const
 This is the const version of head(NType). More...
 
template<int N>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedSegmentReturnType< N >::Type head (Index n=N)
 
template<int N>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ConstFixedSegmentReturnType< N >::Type head (Index n=N) const
 This is the const version of head<int>(). More...
 
EIGEN_DEVICE_FUNC const ImagReturnType imag () const
 
EIGEN_DEVICE_FUNC NonConstImagReturnType imag ()
 
EIGEN_DEVICE_FUNC EIGEN_CONSTEXPR Index innerSize () const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE InnerVectorReturnType innerVector (Index outer)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ConstInnerVectorReturnType innerVector (Index outer) const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE InnerVectorsReturnType innerVectors (Index outerStart, Index outerSize)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ConstInnerVectorsReturnType innerVectors (Index outerStart, Index outerSize) 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 >
EIGEN_DEVICE_FUNC bool isMuchSmallerThan (const typename NumTraits< Scalar >::Real &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_DEVICE_FUNC EIGEN_STRONG_INLINE Derived & lazyAssign (const DenseBase< OtherDerived > &other)
 
template<typename OtherDerived >
EIGEN_DEPRECATED EIGEN_DEVICE_FUNC Derived & lazyAssign (const DenseBase< OtherDerived > &other)
 
template<typename NColsType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NColsBlockXpr< internal::get_fixed_value< NColsType >::value >::Type leftCols (NColsType n)
 
template<typename NColsType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ConstNColsBlockXpr< internal::get_fixed_value< NColsType >::value >::Type leftCols (NColsType n) const
 This is the const version of leftCols(NColsType). More...
 
template<int N>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NColsBlockXpr< N >::Type leftCols (Index n=N)
 
template<int N>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ConstNColsBlockXpr< N >::Type leftCols (Index n=N) const
 This is the const version of leftCols<int>(). More...
 
template<int p>
RealScalar lpNorm () const
 
template<int NaNPropagation>
EIGEN_DEVICE_FUNC internal::traits< Derived >::Scalar maxCoeff () const
 
EIGEN_DEVICE_FUNC internal::traits< Derived >::Scalar maxCoeff () const
 
template<int NaNPropagation, typename IndexType >
EIGEN_DEVICE_FUNC internal::traits< Derived >::Scalar maxCoeff (IndexType *row, IndexType *col) const
 
template<int NaNPropagation, typename IndexType >
EIGEN_DEVICE_FUNC internal::traits< Derived >::Scalar maxCoeff (IndexType *index) 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
 
template<typename NColsType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NColsBlockXpr< internal::get_fixed_value< NColsType >::value >::Type middleCols (Index startCol, NColsType numCols)
 
template<typename NColsType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ConstNColsBlockXpr< internal::get_fixed_value< NColsType >::value >::Type middleCols (Index startCol, NColsType numCols) const
 This is the const version of middleCols(Index,NColsType). More...
 
template<int N>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NColsBlockXpr< N >::Type middleCols (Index startCol, Index n=N)
 
template<int N>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ConstNColsBlockXpr< N >::Type middleCols (Index startCol, Index n=N) const
 This is the const version of middleCols<int>(). More...
 
template<typename NRowsType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NRowsBlockXpr< internal::get_fixed_value< NRowsType >::value >::Type middleRows (Index startRow, NRowsType n)
 
template<typename NRowsType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ConstNRowsBlockXpr< internal::get_fixed_value< NRowsType >::value >::Type middleRows (Index startRow, NRowsType n) const
 This is the const version of middleRows(Index,NRowsType). More...
 
template<int N>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NRowsBlockXpr< N >::Type middleRows (Index startRow, Index n=N)
 
template<int N>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ConstNRowsBlockXpr< N >::Type middleRows (Index startRow, Index n=N) const
 This is the const version of middleRows<int>(). More...
 
template<int NaNPropagation>
EIGEN_DEVICE_FUNC internal::traits< Derived >::Scalar minCoeff () const
 
EIGEN_DEVICE_FUNC internal::traits< Derived >::Scalar minCoeff () const
 
template<int NaNPropagation, typename IndexType >
EIGEN_DEVICE_FUNC internal::traits< Derived >::Scalar minCoeff (IndexType *row, IndexType *col) const
 
template<int NaNPropagation, typename IndexType >
EIGEN_DEVICE_FUNC internal::traits< Derived >::Scalar minCoeff (IndexType *index) 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 EIGEN_CONSTEXPR 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_DEVICE_FUNC 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)
 
template<typename RowIndices , typename ColIndices >
internal::enable_if< internal::valid_indexed_view_overload< RowIndices, ColIndices >::value &&internal::traits< typename EIGEN_INDEXED_VIEW_METHOD_TYPE< RowIndices, ColIndices >::type >::ReturnAsIndexedView, typename EIGEN_INDEXED_VIEW_METHOD_TYPE< RowIndices, ColIndices >::type >::type operator() (const RowIndices &rowIndices, const ColIndices &colIndices) EIGEN_INDEXED_VIEW_METHOD_CONST
 
template<typename RowIndices , typename ColIndices >
internal::enable_if< internal::valid_indexed_view_overload< RowIndices, ColIndices >::value &&internal::traits< typename EIGEN_INDEXED_VIEW_METHOD_TYPE< RowIndices, ColIndices >::type >::ReturnAsIndexedView, typename EIGEN_INDEXED_VIEW_METHOD_TYPE< RowIndices, ColIndices >::type >::type operator() (const RowIndices &rowIndices, const ColIndices &colIndices) EIGEN_INDEXED_VIEW_METHOD_CONST
 
template<typename RowIndices , typename ColIndices >
internal::enable_if< internal::valid_indexed_view_overload< RowIndices, ColIndices >::value &&internal::traits< typename EIGEN_INDEXED_VIEW_METHOD_TYPE< RowIndices, ColIndices >::type >::ReturnAsBlock, typename internal::traits< typename EIGEN_INDEXED_VIEW_METHOD_TYPE< RowIndices, ColIndices >::type >::BlockType >::type operator() (const RowIndices &rowIndices, const ColIndices &colIndices) EIGEN_INDEXED_VIEW_METHOD_CONST
 
template<typename RowIndices , typename ColIndices >
internal::enable_if< internal::valid_indexed_view_overload< RowIndices, ColIndices >::value &&internal::traits< typename EIGEN_INDEXED_VIEW_METHOD_TYPE< RowIndices, ColIndices >::type >::ReturnAsBlock, typename internal::traits< typename EIGEN_INDEXED_VIEW_METHOD_TYPE< RowIndices, ColIndices >::type >::BlockType >::type operator() (const RowIndices &rowIndices, const ColIndices &colIndices) EIGEN_INDEXED_VIEW_METHOD_CONST
 
template<typename RowIndices , typename ColIndices >
internal::enable_if< internal::valid_indexed_view_overload< RowIndices, ColIndices >::value &&internal::traits< typename EIGEN_INDEXED_VIEW_METHOD_TYPE< RowIndices, ColIndices >::type >::ReturnAsScalar, CoeffReturnType >::type operator() (const RowIndices &rowIndices, const ColIndices &colIndices) EIGEN_INDEXED_VIEW_METHOD_CONST
 
template<typename RowIndices , typename ColIndices >
internal::enable_if< internal::valid_indexed_view_overload< RowIndices, ColIndices >::value &&internal::traits< typename EIGEN_INDEXED_VIEW_METHOD_TYPE< RowIndices, ColIndices >::type >::ReturnAsScalar, CoeffReturnType >::type operator() (const RowIndices &rowIndices, const ColIndices &colIndices) EIGEN_INDEXED_VIEW_METHOD_CONST
 
template<typename Indices >
internal::enable_if< IsRowMajor &&(!(internal::get_compile_time_incr< typename IvcType< Indices >::type >::value==1||internal::is_valid_index_type< Indices >::value)), IndexedView< EIGEN_INDEXED_VIEW_METHOD_CONST Derived, IvcIndex, typename IvcType< Indices >::type > >::type operator() (const Indices &indices) EIGEN_INDEXED_VIEW_METHOD_CONST
 
template<typename Indices >
internal::enable_if< IsRowMajor &&(!(internal::get_compile_time_incr< typename IvcType< Indices >::type >::value==1||internal::is_valid_index_type< Indices >::value)), IndexedView< EIGEN_INDEXED_VIEW_METHOD_CONST Derived, IvcIndex, typename IvcType< Indices >::type > >::type operator() (const Indices &indices) EIGEN_INDEXED_VIEW_METHOD_CONST
 
template<typename Indices >
internal::enable_if<(!IsRowMajor) &&(!(internal::get_compile_time_incr< typename IvcType< Indices >::type >::value==1||internal::is_valid_index_type< Indices >::value)), IndexedView< EIGEN_INDEXED_VIEW_METHOD_CONST Derived, typename IvcType< Indices >::type, IvcIndex > >::type operator() (const Indices &indices) EIGEN_INDEXED_VIEW_METHOD_CONST
 
template<typename Indices >
internal::enable_if<(!IsRowMajor) &&(!(internal::get_compile_time_incr< typename IvcType< Indices >::type >::value==1||internal::is_valid_index_type< Indices >::value)), IndexedView< EIGEN_INDEXED_VIEW_METHOD_CONST Derived, typename IvcType< Indices >::type, IvcIndex > >::type operator() (const Indices &indices) EIGEN_INDEXED_VIEW_METHOD_CONST
 
template<typename Indices >
internal::enable_if<(internal::get_compile_time_incr< typename IvcType< Indices >::type >::value==1) &&(!internal::is_valid_index_type< Indices >::value) &&(!symbolic::is_symbolic< Indices >::value), VectorBlock< EIGEN_INDEXED_VIEW_METHOD_CONST Derived, internal::array_size< Indices >::value > >::type operator() (const Indices &indices) EIGEN_INDEXED_VIEW_METHOD_CONST
 
template<typename Indices >
internal::enable_if<(internal::get_compile_time_incr< typename IvcType< Indices >::type >::value==1) &&(!internal::is_valid_index_type< Indices >::value) &&(!symbolic::is_symbolic< Indices >::value), VectorBlock< EIGEN_INDEXED_VIEW_METHOD_CONST Derived, internal::array_size< Indices >::value > >::type operator() (const Indices &indices) EIGEN_INDEXED_VIEW_METHOD_CONST
 
template<typename IndexType >
internal::enable_if< symbolic::is_symbolic< IndexType >::value, CoeffReturnType >::type operator() (const IndexType &id) EIGEN_INDEXED_VIEW_METHOD_CONST
 
template<typename IndexType >
internal::enable_if< symbolic::is_symbolic< IndexType >::value, CoeffReturnType >::type operator() (const IndexType &id) EIGEN_INDEXED_VIEW_METHOD_CONST
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE Derived & operator*= (const Scalar &other)
 
template<typename OtherDerived >
EIGEN_DEVICE_FUNC Derived & operator+= (const EigenBase< OtherDerived > &other)
 
EIGEN_DEVICE_FUNC const NegativeReturnType operator- () const
 
template<typename OtherDerived >
EIGEN_DEVICE_FUNC Derived & operator-= (const EigenBase< OtherDerived > &other)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE Derived & operator/= (const Scalar &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 >
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 EIGEN_CONSTEXPR Index outerSize () const
 
EIGEN_DEVICE_FUNC Scalar prod () const
 
EIGEN_DEVICE_FUNC RealReturnType real () const
 
EIGEN_DEVICE_FUNC NonConstRealReturnType real ()
 
template<typename Func >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE 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>
EIGEN_DEVICE_FUNC const Replicate< Derived, RowFactor, ColFactor > replicate () const
 
EIGEN_DEVICE_FUNC const Replicate< Derived, Dynamic, Dynamicreplicate (Index rowFactor, Index colFactor) const
 
template<typename NRowsType , typename NColsType >
EIGEN_DEVICE_FUNC Reshaped< EIGEN_RESHAPED_METHOD_CONST Derived, internal::get_compiletime_reshape_size< NRowsType, NColsType, SizeAtCompileTime >::value, internal::get_compiletime_reshape_size< NColsType, NRowsType, SizeAtCompileTime >::valuereshaped (NRowsType nRows, NColsType nCols) EIGEN_RESHAPED_METHOD_CONST
 
template<typename NRowsType , typename NColsType >
EIGEN_DEVICE_FUNC Reshaped< EIGEN_RESHAPED_METHOD_CONST Derived, internal::get_compiletime_reshape_size< NRowsType, NColsType, SizeAtCompileTime >::value, internal::get_compiletime_reshape_size< NColsType, NRowsType, SizeAtCompileTime >::valuereshaped (NRowsType nRows, NColsType nCols) EIGEN_RESHAPED_METHOD_CONST
 
template<int Order, typename NRowsType , typename NColsType >
EIGEN_DEVICE_FUNC Reshaped< EIGEN_RESHAPED_METHOD_CONST Derived, internal::get_compiletime_reshape_size< NRowsType, NColsType, SizeAtCompileTime >::value, internal::get_compiletime_reshape_size< NColsType, NRowsType, SizeAtCompileTime >::value, internal::get_compiletime_reshape_order< Flags, Order >::valuereshaped (NRowsType nRows, NColsType nCols) EIGEN_RESHAPED_METHOD_CONST
 
template<int Order, typename NRowsType , typename NColsType >
EIGEN_DEVICE_FUNC Reshaped< EIGEN_RESHAPED_METHOD_CONST Derived, internal::get_compiletime_reshape_size< NRowsType, NColsType, SizeAtCompileTime >::value, internal::get_compiletime_reshape_size< NColsType, NRowsType, SizeAtCompileTime >::value, internal::get_compiletime_reshape_order< Flags, Order >::valuereshaped (NRowsType nRows, NColsType nCols) EIGEN_RESHAPED_METHOD_CONST
 
EIGEN_DEVICE_FUNC Reshaped< EIGEN_RESHAPED_METHOD_CONST Derived, SizeAtCompileTime, 1 > reshaped () EIGEN_RESHAPED_METHOD_CONST
 
EIGEN_DEVICE_FUNC Reshaped< EIGEN_RESHAPED_METHOD_CONST Derived, SizeAtCompileTime, 1 > reshaped () EIGEN_RESHAPED_METHOD_CONST
 
template<int Order>
EIGEN_DEVICE_FUNC Reshaped< EIGEN_RESHAPED_METHOD_CONST Derived, SizeAtCompileTime, 1, internal::get_compiletime_reshape_order< Flags, Order >::valuereshaped () EIGEN_RESHAPED_METHOD_CONST
 
template<int Order>
EIGEN_DEVICE_FUNC Reshaped< EIGEN_RESHAPED_METHOD_CONST Derived, SizeAtCompileTime, 1, internal::get_compiletime_reshape_order< Flags, Order >::valuereshaped () EIGEN_RESHAPED_METHOD_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 ()
 
template<typename NColsType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NColsBlockXpr< internal::get_fixed_value< NColsType >::value >::Type rightCols (NColsType n)
 
template<typename NColsType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ConstNColsBlockXpr< internal::get_fixed_value< NColsType >::value >::Type rightCols (NColsType n) const
 This is the const version of rightCols(NColsType). More...
 
template<int N>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NColsBlockXpr< N >::Type rightCols (Index n=N)
 
template<int N>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ConstNColsBlockXpr< N >::Type rightCols (Index n=N) const
 This is the const version of rightCols<int>(). More...
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE RowXpr row (Index i)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ConstRowXpr row (Index i) const
 This is the const version of row(). */. More...
 
EIGEN_DEVICE_FUNC ConstRowwiseReturnType rowwise () const
 
EIGEN_DEVICE_FUNC RowwiseReturnType rowwise ()
 
template<typename NType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedSegmentReturnType< internal::get_fixed_value< NType >::value >::Type segment (Index start, NType n)
 
template<typename NType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ConstFixedSegmentReturnType< internal::get_fixed_value< NType >::value >::Type segment (Index start, NType n) const
 This is the const version of segment(Index,NType). More...
 
template<int N>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedSegmentReturnType< N >::Type segment (Index start, Index n=N)
 
template<int N>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE 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 >
EIGEN_DEVICE_FUNC const Select< Derived, ThenDerived, ElseDerived > select (const DenseBase< ThenDerived > &thenMatrix, const DenseBase< ElseDerived > &elseMatrix) const
 
template<typename ThenDerived >
EIGEN_DEVICE_FUNC const Select< Derived, ThenDerived, typename ThenDerived::ConstantReturnType > select (const DenseBase< ThenDerived > &thenMatrix, const typename ThenDerived::Scalar &elseScalar) const
 
template<typename ElseDerived >
EIGEN_DEVICE_FUNC 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 ()
 
template<DirectionType Direction>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE internal::conditional< Direction==Vertical, ColXpr, RowXpr >::type subVector (Index i)
 
template<DirectionType Direction>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE internal::conditional< Direction==Vertical, ConstColXpr, ConstRowXpr >::type subVector (Index i) const
 
template<DirectionType Direction>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE EIGEN_CONSTEXPR Index subVectors () const
 
EIGEN_DEVICE_FUNC Scalar sum () const
 
template<typename OtherDerived >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void swap (const DenseBase< OtherDerived > &other)
 
template<typename OtherDerived >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE void swap (PlainObjectBase< OtherDerived > &other)
 
template<typename NType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedSegmentReturnType< internal::get_fixed_value< NType >::value >::Type tail (NType n)
 
template<typename NType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ConstFixedSegmentReturnType< internal::get_fixed_value< NType >::value >::Type tail (NType n) const
 This is the const version of tail(Index). More...
 
template<int N>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedSegmentReturnType< N >::Type tail (Index n=N)
 
template<int N>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ConstFixedSegmentReturnType< N >::Type tail (Index n=N) const
 This is the const version of tail<int>. More...
 
template<typename NRowsType , typename NColsType >
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedBlockXpr< internal::get_fixed_value< NRowsType >::value, internal::get_fixed_value< NColsType >::value >::Type topLeftCorner (NRowsType cRows, NColsType cCols)
 
template<typename NRowsType , typename NColsType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ConstFixedBlockXpr< internal::get_fixed_value< NRowsType >::value, internal::get_fixed_value< NColsType >::value >::Type topLeftCorner (NRowsType cRows, NColsType 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 EIGEN_STRONG_INLINE FixedBlockXpr< CRows, CCols >::Type topLeftCorner ()
 
template<int CRows, int CCols>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE 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 EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedBlockXpr< CRows, CCols >::Type topLeftCorner (Index cRows, Index cCols)
 
template<int CRows, int CCols>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ConstFixedBlockXpr< CRows, CCols >::Type topLeftCorner (Index cRows, Index cCols) const
 This is the const version of topLeftCorner<int, int>(Index, Index). More...
 
template<typename NRowsType , typename NColsType >
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedBlockXpr< internal::get_fixed_value< NRowsType >::value, internal::get_fixed_value< NColsType >::value >::Type topRightCorner (NRowsType cRows, NColsType cCols)
 
template<typename NRowsType , typename NColsType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ConstFixedBlockXpr< internal::get_fixed_value< NRowsType >::value, internal::get_fixed_value< NColsType >::value >::Type topRightCorner (NRowsType cRows, NColsType cCols) const
 This is the const version of topRightCorner(NRowsType, NColsType). More...
 
template<int CRows, int CCols>
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedBlockXpr< CRows, CCols >::Type topRightCorner ()
 
template<int CRows, int CCols>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE 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 EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedBlockXpr< CRows, CCols >::Type topRightCorner (Index cRows, Index cCols)
 
template<int CRows, int CCols>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ConstFixedBlockXpr< CRows, CCols >::Type topRightCorner (Index cRows, Index cCols) const
 This is the const version of topRightCorner<int, int>(Index, Index). More...
 
template<typename NRowsType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NRowsBlockXpr< internal::get_fixed_value< NRowsType >::value >::Type topRows (NRowsType n)
 
template<typename NRowsType >
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ConstNRowsBlockXpr< internal::get_fixed_value< NRowsType >::value >::Type topRows (NRowsType n) const
 This is the const version of topRows(NRowsType). More...
 
template<int N>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NRowsBlockXpr< N >::Type topRows (Index n=N)
 
template<int N>
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE 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 ()
 
template<typename CustomUnaryOp >
EIGEN_DEVICE_FUNC const CwiseUnaryOp< CustomUnaryOp, const Derived > unaryExpr (const CustomUnaryOp &func=CustomUnaryOp()) const
 Apply a unary operator coefficient-wise. More...
 
template<typename CustomViewOp >
EIGEN_DEVICE_FUNC const CwiseUnaryView< CustomViewOp, const Derived > unaryViewExpr (const CustomViewOp &func=CustomViewOp()) const
 
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::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)
 
EIGEN_DEPRECATED static EIGEN_DEVICE_FUNC const RandomAccessLinSpacedReturnType LinSpaced (Sequential_t, Index size, const Scalar &low, const Scalar &high)
 
EIGEN_DEPRECATED static EIGEN_DEVICE_FUNC const RandomAccessLinSpacedReturnType LinSpaced (Sequential_t, 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 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 ()
 
- Public Attributes inherited from Eigen::DenseBase< Derived >
EIGEN_DEPRECATED typedef CwiseNullaryOp< internal::linspaced_op< Scalar >, PlainObjectSequentialLinSpacedReturnType
 
- Protected Types inherited from Eigen::DenseBase< Derived >
typedef internal::IndexedViewCompatibleType< Index, 1 >::type IvcIndex
 
- Protected Member Functions inherited from Eigen::ArrayBase< ArrayWrapper< ExpressionType > >
ArrayWrapper< ExpressionType > & operator+= (const MatrixBase< OtherDerived > &)
 
ArrayWrapper< ExpressionType > & operator-= (const MatrixBase< OtherDerived > &)
 
- Protected Member Functions inherited from Eigen::DenseBase< Derived >
EIGEN_DEVICE_FUNC DenseBase ()
 
template<typename Indices >
IvcColType< Indices >::type ivcCol (const Indices &indices) const
 
template<typename Indices >
IvcRowType< Indices >::type ivcRow (const Indices &indices) const
 
template<typename Indices >
IvcColType< Indices >::type ivcSize (const Indices &indices) const
 

Detailed Description

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

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

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

See also
MatrixBase::array(), class MatrixWrapper

Definition at line 42 of file ArrayWrapper.h.

Member Typedef Documentation

◆ Base

template<typename ExpressionType>
typedef ArrayBase<ArrayWrapper> Eigen::ArrayWrapper< ExpressionType >::Base

Definition at line 45 of file ArrayWrapper.h.

◆ NestedExpression

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

Definition at line 48 of file ArrayWrapper.h.

◆ NestedExpressionType

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

Definition at line 56 of file ArrayWrapper.h.

◆ ScalarWithConstIfNotLvalue

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

Definition at line 54 of file ArrayWrapper.h.

Constructor & Destructor Documentation

◆ ArrayWrapper()

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

Definition at line 61 of file ArrayWrapper.h.

Member Function Documentation

◆ coeffRef() [1/2]

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

Definition at line 78 of file ArrayWrapper.h.

◆ coeffRef() [2/2]

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

Definition at line 84 of file ArrayWrapper.h.

◆ cols()

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

Definition at line 66 of file ArrayWrapper.h.

◆ data() [1/2]

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

Definition at line 73 of file ArrayWrapper.h.

◆ data() [2/2]

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

Definition at line 75 of file ArrayWrapper.h.

◆ evalTo()

template<typename ExpressionType>
template<typename Dest >
EIGEN_DEVICE_FUNC void Eigen::ArrayWrapper< ExpressionType >::evalTo ( Dest &  dst) const
inline

Definition at line 91 of file ArrayWrapper.h.

◆ innerStride()

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

Definition at line 70 of file ArrayWrapper.h.

◆ nestedExpression()

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

Definition at line 95 of file ArrayWrapper.h.

◆ outerStride()

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

Definition at line 68 of file ArrayWrapper.h.

◆ resize() [1/2]

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

Forwards the resizing request to the nested expression

See also
DenseBase::resize(Index)

Definition at line 103 of file ArrayWrapper.h.

◆ resize() [2/2]

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

Forwards the resizing request to the nested expression

See also
DenseBase::resize(Index,Index)

Definition at line 107 of file ArrayWrapper.h.

◆ rows()

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

Definition at line 64 of file ArrayWrapper.h.

Member Data Documentation

◆ m_expression

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

Definition at line 110 of file ArrayWrapper.h.


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


gtsam
Author(s):
autogenerated on Tue Jul 4 2023 02:41:19