Public Types | Public Member Functions | Protected Types | Protected Member Functions | Protected Attributes | Private Types | List of all members
Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse > Class Template Reference

#include <SparseBlock.h>

Inheritance diagram for Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse >:
Inheritance graph
[legend]

Public Types

enum  { IsRowMajor = internal::traits<BlockType>::IsRowMajor }
 
- Public Types inherited from Eigen::SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >
enum  
 
typedef internal::conditional< NumTraits< Scalar >::IsComplex, CwiseUnaryOp< internal::scalar_conjugate_op< Scalar >, Eigen::Transpose< const Block< XprType, BlockRows, BlockCols, true > > >, Transpose< const Block< XprType, BlockRows, BlockCols, true > > >::type AdjointReturnType
 
typedef EigenBase< Block< XprType, BlockRows, BlockCols, true > > Base
 
typedef Block< Block< XprType, BlockRows, BlockCols, true > > BlockXpr
 
typedef internal::conditional< _HasDirectAccess, const Scalar &, Scalar >::type CoeffReturnType
 
typedef Block< Block< XprType, BlockRows, BlockCols, true >, internal::traits< Block< XprType, BlockRows, BlockCols, true > >::RowsAtCompileTime, Dynamic, !IsRowMajorColsBlockXpr
 
typedef Block< Block< XprType, BlockRows, BlockCols, true >, internal::traits< Block< XprType, BlockRows, BlockCols, true > >::RowsAtCompileTime, 1, !IsRowMajorColXpr
 
typedef internal::conditional< NumTraits< Scalar >::IsComplex, const CwiseUnaryOp< internal::scalar_conjugate_op< Scalar >, const Block< XprType, BlockRows, BlockCols, true > >, const Block< XprType, BlockRows, BlockCols, true > & >::type ConjugateReturnType
 
typedef CwiseNullaryOp< internal::scalar_constant_op< Scalar >, Matrix< Scalar, Dynamic, Dynamic > > ConstantReturnType
 
typedef const Block< const Block< XprType, BlockRows, BlockCols, true > > ConstBlockXpr
 
typedef const Block< const Block< XprType, BlockRows, BlockCols, true >, internal::traits< Block< XprType, BlockRows, BlockCols, true > >::RowsAtCompileTime, Dynamic, !IsRowMajorConstColsBlockXpr
 
typedef const Block< const Block< XprType, BlockRows, BlockCols, true >, internal::traits< Block< XprType, BlockRows, BlockCols, true > >::RowsAtCompileTime, 1, !IsRowMajorConstColXpr
 
typedef Block< const Block< XprType, BlockRows, BlockCols, true >, IsRowMajor?1:Dynamic, IsRowMajor?Dynamic:1, true > ConstInnerVectorReturnType
 
typedef Block< const Block< XprType, BlockRows, BlockCols, true >, Dynamic, Dynamic, true > ConstInnerVectorsReturnType
 
typedef const Block< const Block< XprType, BlockRows, BlockCols, true >, Dynamic, internal::traits< Block< XprType, BlockRows, BlockCols, true > >::ColsAtCompileTime, IsRowMajorConstRowsBlockXpr
 
typedef const Block< const Block< XprType, BlockRows, BlockCols, true >, 1, internal::traits< Block< XprType, BlockRows, BlockCols, true > >::ColsAtCompileTime, IsRowMajorConstRowXpr
 
typedef const VectorBlock< const Block< XprType, BlockRows, BlockCols, true > > ConstSegmentReturnType
 
typedef internal::add_const< Transpose< const Block< XprType, BlockRows, BlockCols, true > > >::type ConstTransposeReturnType
 
typedef CwiseUnaryOp< internal::scalar_abs2_op< Scalar >, const Block< XprType, BlockRows, BlockCols, true > > CwiseAbs2ReturnType
 
typedef CwiseUnaryOp< internal::scalar_abs_op< Scalar >, const Block< XprType, BlockRows, BlockCols, true > > CwiseAbsReturnType
 
typedef CwiseUnaryOp< internal::scalar_arg_op< Scalar >, const Block< XprType, BlockRows, BlockCols, true > > CwiseArgReturnType
 
typedef CwiseUnaryOp< internal::scalar_inverse_op< Scalar >, const Block< XprType, BlockRows, BlockCols, true > > CwiseInverseReturnType
 
typedef CwiseBinaryOp< internal::scalar_cmp_op< Scalar, Scalar, internal::cmp_EQ >, const Block< XprType, BlockRows, BlockCols, true >, const ConstantReturnTypeCwiseScalarEqualReturnType
 
typedef CwiseUnaryOp< internal::scalar_sign_op< Scalar >, const Block< XprType, BlockRows, BlockCols, true > > CwiseSignReturnType
 
typedef CwiseUnaryOp< internal::scalar_sqrt_op< Scalar >, const Block< XprType, BlockRows, BlockCols, true > > CwiseSqrtReturnType
 
typedef Matrix< Scalar, RowsAtCompileTime, ColsAtCompileTimeDenseMatrixType
 
typedef CwiseUnaryOp< internal::scalar_imag_op< Scalar >, const Block< XprType, BlockRows, BlockCols, true > > ImagReturnType
 
typedef Matrix< StorageIndex, Dynamic, 1 > IndexVector
 
typedef Block< Block< XprType, BlockRows, BlockCols, true >, IsRowMajor?1:Dynamic, IsRowMajor?Dynamic:1, true > InnerVectorReturnType
 
typedef Block< Block< XprType, BlockRows, BlockCols, true >, Dynamic, Dynamic, true > InnerVectorsReturnType
 
typedef CwiseUnaryOp< internal::scalar_opposite_op< Scalar >, const Block< XprType, BlockRows, BlockCols, true > > NegativeReturnType
 
typedef CwiseUnaryView< internal::scalar_imag_ref_op< Scalar >, Block< XprType, BlockRows, BlockCols, true > > NonConstImagReturnType
 
typedef internal::conditional< NumTraits< Scalar >::IsComplex, CwiseUnaryView< internal::scalar_real_ref_op< Scalar >, Block< XprType, BlockRows, BlockCols, true > >, Block< XprType, BlockRows, BlockCols, true > & >::type NonConstRealReturnType
 
typedef internal::add_const_on_value_type_if_arithmetic< typename internal::packet_traits< Scalar >::type >::type PacketReturnType
 
typedef internal::packet_traits< Scalar >::type PacketScalar
 
typedef SparseMatrix< Scalar, Flags &RowMajorBit ? RowMajor :ColMajor, StorageIndexPlainObject
 
typedef internal::conditional< NumTraits< Scalar >::IsComplex, const CwiseUnaryOp< internal::scalar_real_op< Scalar >, const Block< XprType, BlockRows, BlockCols, true > >, const Block< XprType, BlockRows, BlockCols, true > & >::type RealReturnType
 
typedef NumTraits< Scalar >::Real RealScalar
 
typedef Block< Block< XprType, BlockRows, BlockCols, true >, Dynamic, internal::traits< Block< XprType, BlockRows, BlockCols, true > >::ColsAtCompileTime, IsRowMajorRowsBlockXpr
 
typedef Block< Block< XprType, BlockRows, BlockCols, true >, 1, internal::traits< Block< XprType, BlockRows, BlockCols, true > >::ColsAtCompileTime, IsRowMajorRowXpr
 
typedef internal::traits< Block< XprType, BlockRows, BlockCols, true > >::Scalar Scalar
 
typedef Matrix< Scalar, Dynamic, 1 > ScalarVector
 
typedef VectorBlock< Block< XprType, BlockRows, BlockCols, true > > SegmentReturnType
 
typedef Matrix< Scalar, EIGEN_SIZE_MAX(RowsAtCompileTime, ColsAtCompileTime), EIGEN_SIZE_MAX(RowsAtCompileTime, ColsAtCompileTime)> SquareMatrixType
 
typedef SparseMatrixBase StorageBaseType
 
typedef internal::traits< Block< XprType, BlockRows, BlockCols, true > >::StorageIndex StorageIndex
 
typedef internal::traits< Block< XprType, BlockRows, BlockCols, true > >::StorageKind StorageKind
 
typedef Transpose< Block< XprType, BlockRows, BlockCols, true > > TransposeReturnType
 
typedef Scalar value_type
 
- Public Types inherited from Eigen::EigenBase< Derived >
typedef Eigen::Index Index
 The interface type of indices. More...
 
typedef internal::traits< Derived >::StorageKind StorageKind
 

Public Member Functions

Index blockCols () const
 
 BlockImpl (XprType &xpr, Index i)
 
 BlockImpl (XprType &xpr, Index startRow, Index startCol, Index blockRows, Index blockCols)
 
Index blockRows () const
 
const Scalar coeff (Index row, Index col) const
 
const Scalar coeff (Index index) const
 
EIGEN_STRONG_INLINE Index cols () const
 
const XprTypenestedExpression () const
 
XprTypenestedExpression ()
 
Index nonZeros () const
 
EIGEN_STRONG_INLINE Index rows () const
 
Index startCol () const
 
Index startRow () const
 
- Public Member Functions inherited from Eigen::SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >
const AdjointReturnType adjoint () const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseBinaryOp< CustomBinaryOp, const Block< XprType, BlockRows, BlockCols, true >, const OtherDerived > binaryExpr (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other, const CustomBinaryOp &func=CustomBinaryOp()) const
 
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)
 
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...
 
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedBlockXpr< NRows, NCols >::Type block (Index startRow, Index startCol)
 
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...
 
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)
 
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...
 
RealScalar blueNorm () const
 
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)
 
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...
 
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedBlockXpr< CRows, CCols >::Type bottomLeftCorner ()
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ConstFixedBlockXpr< CRows, CCols >::Type bottomLeftCorner () const
 This is the const version of bottomLeftCorner<int, int>(). More...
 
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_STRONG_INLINE FixedBlockXpr< CRows, CCols >::Type bottomLeftCorner (Index cRows, Index 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...
 
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)
 
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...
 
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedBlockXpr< CRows, CCols >::Type bottomRightCorner ()
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ConstFixedBlockXpr< CRows, CCols >::Type bottomRightCorner () const
 This is the const version of bottomRightCorner<int, int>(). More...
 
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedBlockXpr< CRows, CCols >::Type bottomRightCorner (Index cRows, Index 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...
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NRowsBlockXpr< internal::get_fixed_value< NRowsType >::value >::Type bottomRows (NRowsType n)
 
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...
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NRowsBlockXpr< N >::Type bottomRows (Index n=N)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ConstNRowsBlockXpr< N >::Type bottomRows (Index n=N) const
 This is the const version of bottomRows<int>(). More...
 
EIGEN_DEVICE_FUNC CastXpr< NewType >::Type cast () 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...
 
Index cols () const
 
EIGEN_DEVICE_FUNC ConjugateReturnType conjugate () const
 
EIGEN_DEVICE_FUNC internal::conditional< Cond, ConjugateReturnType, const Block< XprType, BlockRows, BlockCols, true > &>::type conjugateIf () const
 
Block< XprType, BlockRows, BlockCols, true > & const_cast_derived () 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 const CwiseBinaryOp< numext::equal_to< Scalar >, const Block< XprType, BlockRows, BlockCols, true >, 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 Block< XprType, BlockRows, BlockCols, true >, 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 Block< XprType, BlockRows, BlockCols, true >, const ConstantReturnTypecwiseMax (const Scalar &other) const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_min_op< Scalar, Scalar >, const Block< XprType, BlockRows, BlockCols, true >, 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 Block< XprType, BlockRows, BlockCols, true >, const ConstantReturnTypecwiseMin (const Scalar &other) const
 
EIGEN_DEVICE_FUNC const CwiseBinaryOp< numext::not_equal_to< Scalar >, const Block< XprType, BlockRows, BlockCols, true >, const OtherDerived > cwiseNotEqual (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
EIGEN_STRONG_INLINE const CwiseProductDenseReturnType< OtherDerived >::Type cwiseProduct (const MatrixBase< OtherDerived > &other) const
 
EIGEN_STRONG_INLINE const SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::template CwiseProductDenseReturnType< OtherDerived >::Type cwiseProduct (const MatrixBase< OtherDerived > &other) const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_quotient_op< Scalar >, const Block< XprType, BlockRows, BlockCols, true >, 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
 
const Block< XprType, BlockRows, BlockCols, true > & derived () const
 
Block< XprType, BlockRows, BlockCols, true > & derived ()
 
internal::traits< Block< XprType, BlockRows, BlockCols, true > >::Scalar dot (const MatrixBase< OtherDerived > &other) const
 
internal::traits< Block< XprType, BlockRows, BlockCols, true > >::Scalar dot (const SparseMatrixBase< OtherDerived > &other) const
 
Scalar dot (const MatrixBase< OtherDerived > &other) const
 
Scalar dot (const SparseMatrixBase< OtherDerived > &other) const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const EIGEN_CWISE_BINARY_RETURN_TYPE (Block< XprType, BlockRows, BlockCols, true >, OtherDerived, product) cwiseProduct(const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
const internal::eval< Block< XprType, BlockRows, BlockCols, true > >::type eval () const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedSegmentReturnType< internal::get_fixed_value< NType >::value >::Type head (NType n)
 
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...
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedSegmentReturnType< N >::Type head (Index n=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 ()
 
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
 
bool isApprox (const SparseMatrixBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const
 
bool isApprox (const MatrixBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const
 
bool isRValue () const
 
bool isVector () const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NColsBlockXpr< internal::get_fixed_value< NColsType >::value >::Type leftCols (NColsType n)
 
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...
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NColsBlockXpr< N >::Type leftCols (Index n=N)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ConstNColsBlockXpr< N >::Type leftCols (Index n=N) const
 This is the const version of leftCols<int>(). More...
 
Block< XprType, BlockRows, BlockCols, true > & markAsRValue ()
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NColsBlockXpr< internal::get_fixed_value< NColsType >::value >::Type middleCols (Index startCol, NColsType numCols)
 
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...
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NColsBlockXpr< N >::Type middleCols (Index startCol, Index n=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...
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NRowsBlockXpr< internal::get_fixed_value< NRowsType >::value >::Type middleRows (Index startRow, NRowsType n)
 
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...
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NRowsBlockXpr< N >::Type middleRows (Index startRow, Index n=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...
 
RealScalar norm () const
 
EIGEN_DEVICE_FUNC const CwiseBinaryOp< internal::scalar_boolean_and_op, const Block< XprType, BlockRows, BlockCols, true >, const OtherDerived > operator&& (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
const Product< Block< XprType, BlockRows, BlockCols, true >, OtherDerived > operator* (const DiagonalBase< OtherDerived > &other) const
 
const Product< Block< XprType, BlockRows, BlockCols, true >, OtherDerived, AliasFreeProduct > operator* (const SparseMatrixBase< OtherDerived > &other) const
 
const Product< Block< XprType, BlockRows, BlockCols, true >, OtherDerived > operator* (const MatrixBase< OtherDerived > &other) const
 
Block< XprType, BlockRows, BlockCols, true > & operator*= (const Scalar &other)
 
Block< XprType, BlockRows, BlockCols, true > & operator*= (const SparseMatrixBase< OtherDerived > &other)
 
Block< XprType, BlockRows, BlockCols, true > & operator+= (const SparseMatrixBase< OtherDerived > &other)
 
Block< XprType, BlockRows, BlockCols, true > & operator+= (const DiagonalBase< OtherDerived > &other)
 
Block< XprType, BlockRows, BlockCols, true > & operator+= (const EigenBase< OtherDerived > &other)
 
EIGEN_STRONG_INLINE Block< XprType, BlockRows, BlockCols, true > & operator+= (const SparseMatrixBase< OtherDerived > &other)
 
EIGEN_DEVICE_FUNC const NegativeReturnType operator- () const
 
Block< XprType, BlockRows, BlockCols, true > & operator-= (const SparseMatrixBase< OtherDerived > &other)
 
Block< XprType, BlockRows, BlockCols, true > & operator-= (const DiagonalBase< OtherDerived > &other)
 
Block< XprType, BlockRows, BlockCols, true > & operator-= (const EigenBase< OtherDerived > &other)
 
EIGEN_STRONG_INLINE Block< XprType, BlockRows, BlockCols, true > & operator-= (const SparseMatrixBase< OtherDerived > &other)
 
Block< XprType, BlockRows, BlockCols, true > & operator/= (const Scalar &other)
 
Block< XprType, BlockRows, BlockCols, true > & operator= (const EigenBase< OtherDerived > &other)
 
Block< XprType, BlockRows, BlockCols, true > & operator= (const ReturnByValue< OtherDerived > &other)
 
Block< XprType, BlockRows, BlockCols, true > & operator= (const SparseMatrixBase< OtherDerived > &other)
 
Block< XprType, BlockRows, BlockCols, true > & operator= (const Block< XprType, BlockRows, BlockCols, true > &other)
 
EIGEN_DEVICE_FUNC const CwiseBinaryOp< internal::scalar_boolean_or_op, const Block< XprType, BlockRows, BlockCols, true >, const OtherDerived > operator|| (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
Index outerSize () const
 
const SparseView< Block< XprType, BlockRows, BlockCols, true > > pruned (const Scalar &reference=Scalar(0), const RealScalar &epsilon=NumTraits< Scalar >::dummy_precision()) const
 
EIGEN_DEVICE_FUNC RealReturnType real () const
 
EIGEN_DEVICE_FUNC NonConstRealReturnType real ()
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NColsBlockXpr< internal::get_fixed_value< NColsType >::value >::Type rightCols (NColsType n)
 
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...
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NColsBlockXpr< N >::Type rightCols (Index n=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...
 
Index rows () const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedSegmentReturnType< internal::get_fixed_value< NType >::value >::Type segment (Index start, NType n)
 
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...
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedSegmentReturnType< N >::Type segment (Index start, Index n=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...
 
SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::template ConstSelfAdjointViewReturnType< UpLo >::Type selfadjointView () const
 
SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::template SelfAdjointViewReturnType< UpLo >::Type selfadjointView ()
 
ConstSelfAdjointViewReturnType< UpLo >::Type selfadjointView () const
 
SelfAdjointViewReturnType< UpLo >::Type selfadjointView ()
 
Index size () const
 
 SparseMatrixBase ()
 
RealScalar squaredNorm () const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE internal::conditional< Direction==Vertical, ColXpr, RowXpr >::type subVector (Index i)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE internal::conditional< Direction==Vertical, ConstColXpr, ConstRowXpr >::type subVector (Index i) const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE EIGEN_CONSTEXPR Index subVectors () const
 
Scalar sum () const
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedSegmentReturnType< internal::get_fixed_value< NType >::value >::Type tail (NType n)
 
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...
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedSegmentReturnType< N >::Type tail (Index n=N)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ConstFixedSegmentReturnType< N >::Type tail (Index n=N) const
 This is the const version of tail<int>. More...
 
DenseMatrixType toDense () const
 
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)
 
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...
 
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedBlockXpr< CRows, CCols >::Type topLeftCorner ()
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ConstFixedBlockXpr< CRows, CCols >::Type topLeftCorner () const
 This is the const version of topLeftCorner<int, int>(). More...
 
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedBlockXpr< CRows, CCols >::Type topLeftCorner (Index cRows, Index 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...
 
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)
 
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...
 
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedBlockXpr< CRows, CCols >::Type topRightCorner ()
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const ConstFixedBlockXpr< CRows, CCols >::Type topRightCorner () const
 This is the const version of topRightCorner<int, int>(). More...
 
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE FixedBlockXpr< CRows, CCols >::Type topRightCorner (Index cRows, Index 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...
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NRowsBlockXpr< internal::get_fixed_value< NRowsType >::value >::Type topRows (NRowsType n)
 
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...
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE NRowsBlockXpr< N >::Type topRows (Index n=N)
 
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE ConstNRowsBlockXpr< N >::Type topRows (Index n=N) const
 This is the const version of topRows<int>(). More...
 
TransposeReturnType transpose ()
 
const ConstTransposeReturnType transpose () const
 
const TriangularView< const Block< XprType, BlockRows, BlockCols, true >, Mode > triangularView () const
 
SparseSymmetricPermutationProduct< Block< XprType, BlockRows, BlockCols, true >, Upper|Lower > twistedBy (const PermutationMatrix< Dynamic, Dynamic, StorageIndex > &perm) const
 
EIGEN_DEVICE_FUNC const CwiseUnaryOp< CustomUnaryOp, const Block< XprType, BlockRows, BlockCols, true > > unaryExpr (const CustomUnaryOp &func=CustomUnaryOp()) const
 Apply a unary operator coefficient-wise. More...
 
EIGEN_DEVICE_FUNC const CwiseUnaryView< CustomViewOp, const Block< XprType, BlockRows, BlockCols, true > > unaryViewExpr (const CustomViewOp &func=CustomViewOp()) const
 
- Public Member Functions inherited from Eigen::EigenBase< Derived >
template<typename Dest >
EIGEN_DEVICE_FUNC void addTo (Dest &dst) const
 
template<typename Dest >
EIGEN_DEVICE_FUNC void applyThisOnTheLeft (Dest &dst) const
 
template<typename Dest >
EIGEN_DEVICE_FUNC void applyThisOnTheRight (Dest &dst) const
 
EIGEN_DEVICE_FUNC EIGEN_CONSTEXPR Index cols () const EIGEN_NOEXCEPT
 
EIGEN_DEVICE_FUNC Derived & const_cast_derived () const
 
EIGEN_DEVICE_FUNC const Derived & const_derived () const
 
EIGEN_DEVICE_FUNC Derived & derived ()
 
EIGEN_DEVICE_FUNC const Derived & derived () const
 
template<typename Dest >
EIGEN_DEVICE_FUNC void evalTo (Dest &dst) const
 
EIGEN_DEVICE_FUNC EIGEN_CONSTEXPR Index rows () const EIGEN_NOEXCEPT
 
EIGEN_DEVICE_FUNC EIGEN_CONSTEXPR Index size () const EIGEN_NOEXCEPT
 
template<typename Dest >
EIGEN_DEVICE_FUNC void subTo (Dest &dst) const
 

Protected Types

enum  { OuterSize = IsRowMajor ? BlockRows : BlockCols }
 
typedef SparseMatrixBase< BlockTypeBase
 

Protected Member Functions

template<typename T >
BlockImploperator= (const T &)
 
- Protected Member Functions inherited from Eigen::SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >
Block< XprType, BlockRows, BlockCols, true > & assign (const OtherDerived &other)
 
void assignGeneric (const OtherDerived &other)
 

Protected Attributes

internal::ref_selector< XprType >::non_const_type m_matrix
 
const internal::variable_if_dynamic< Index, OuterSizem_outerSize
 
Index m_outerStart
 
- Protected Attributes inherited from Eigen::SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >
bool m_isRValue
 

Private Types

typedef internal::remove_all< typename XprType::Nested >::type _MatrixTypeNested
 
typedef Block< XprType, BlockRows, BlockCols, true > BlockType
 

Additional Inherited Members

- Static Protected Member Functions inherited from Eigen::SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >
static StorageIndex convert_index (const Index idx)
 

Detailed Description

template<typename XprType, int BlockRows, int BlockCols>
class Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse >

Definition at line 17 of file SparseBlock.h.

Member Typedef Documentation

◆ _MatrixTypeNested

template<typename XprType , int BlockRows, int BlockCols>
typedef internal::remove_all<typename XprType::Nested>::type Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse >::_MatrixTypeNested
private

Definition at line 20 of file SparseBlock.h.

◆ Base

template<typename XprType , int BlockRows, int BlockCols>
typedef SparseMatrixBase<BlockType> Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse >::Base
protected

Definition at line 26 of file SparseBlock.h.

◆ BlockType

template<typename XprType , int BlockRows, int BlockCols>
typedef Block<XprType, BlockRows, BlockCols, true> Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse >::BlockType
private

Definition at line 21 of file SparseBlock.h.

Member Enumeration Documentation

◆ anonymous enum

template<typename XprType , int BlockRows, int BlockCols>
anonymous enum
Enumerator
IsRowMajor 

Definition at line 23 of file SparseBlock.h.

◆ anonymous enum

template<typename XprType , int BlockRows, int BlockCols>
anonymous enum
protected
Enumerator
OuterSize 

Definition at line 25 of file SparseBlock.h.

Constructor & Destructor Documentation

◆ BlockImpl() [1/2]

template<typename XprType , int BlockRows, int BlockCols>
Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse >::BlockImpl ( XprType xpr,
Index  i 
)
inline

Definition at line 31 of file SparseBlock.h.

◆ BlockImpl() [2/2]

template<typename XprType , int BlockRows, int BlockCols>
Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse >::BlockImpl ( XprType xpr,
Index  startRow,
Index  startCol,
Index  blockRows,
Index  blockCols 
)
inline

Definition at line 35 of file SparseBlock.h.

Member Function Documentation

◆ blockCols()

template<typename XprType , int BlockRows, int BlockCols>
Index Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse >::blockCols ( ) const
inline

Definition at line 69 of file SparseBlock.h.

◆ blockRows()

template<typename XprType , int BlockRows, int BlockCols>
Index Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse >::blockRows ( ) const
inline

Definition at line 68 of file SparseBlock.h.

◆ coeff() [1/2]

template<typename XprType , int BlockRows, int BlockCols>
const Scalar Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse >::coeff ( Index  row,
Index  col 
) const
inline

Definition at line 54 of file SparseBlock.h.

◆ coeff() [2/2]

template<typename XprType , int BlockRows, int BlockCols>
const Scalar Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse >::coeff ( Index  index) const
inline

Definition at line 59 of file SparseBlock.h.

◆ cols()

template<typename XprType , int BlockRows, int BlockCols>
EIGEN_STRONG_INLINE Index Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse >::cols ( void  ) const
inline

Definition at line 40 of file SparseBlock.h.

◆ nestedExpression() [1/2]

template<typename XprType , int BlockRows, int BlockCols>
const XprType& Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse >::nestedExpression ( ) const
inline

Definition at line 64 of file SparseBlock.h.

◆ nestedExpression() [2/2]

template<typename XprType , int BlockRows, int BlockCols>
XprType& Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse >::nestedExpression ( )
inline

Definition at line 65 of file SparseBlock.h.

◆ nonZeros()

template<typename XprType , int BlockRows, int BlockCols>
Index Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse >::nonZeros ( ) const
inline

Definition at line 42 of file SparseBlock.h.

◆ operator=()

template<typename XprType , int BlockRows, int BlockCols>
template<typename T >
BlockImpl& Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse >::operator= ( const T )
inlineprotected

Definition at line 81 of file SparseBlock.h.

◆ rows()

template<typename XprType , int BlockRows, int BlockCols>
EIGEN_STRONG_INLINE Index Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse >::rows ( void  ) const
inline

Definition at line 39 of file SparseBlock.h.

◆ startCol()

template<typename XprType , int BlockRows, int BlockCols>
Index Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse >::startCol ( ) const
inline

Definition at line 67 of file SparseBlock.h.

◆ startRow()

template<typename XprType , int BlockRows, int BlockCols>
Index Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse >::startRow ( ) const
inline

Definition at line 66 of file SparseBlock.h.

Member Data Documentation

◆ m_matrix

template<typename XprType , int BlockRows, int BlockCols>
internal::ref_selector<XprType>::non_const_type Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse >::m_matrix
protected

Definition at line 73 of file SparseBlock.h.

◆ m_outerSize

template<typename XprType , int BlockRows, int BlockCols>
const internal::variable_if_dynamic<Index, OuterSize> Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse >::m_outerSize
protected

Definition at line 75 of file SparseBlock.h.

◆ m_outerStart

template<typename XprType , int BlockRows, int BlockCols>
Index Eigen::BlockImpl< XprType, BlockRows, BlockCols, true, Sparse >::m_outerStart
protected

Definition at line 74 of file SparseBlock.h.


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


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