Base class of any sparse matrices or sparse expressions. More...
#include <ForwardDeclarations.h>
Classes | |
struct | CastXpr |
struct | ConstFixedBlockXpr |
struct | ConstFixedSegmentReturnType |
struct | ConstNColsBlockXpr |
struct | ConstNRowsBlockXpr |
struct | ConstSelfAdjointViewReturnType |
struct | CwiseProductDenseReturnType |
struct | FixedBlockXpr |
struct | FixedSegmentReturnType |
struct | NColsBlockXpr |
struct | NRowsBlockXpr |
struct | SelfAdjointViewReturnType |
Public Member Functions | |
const AdjointReturnType | adjoint () const |
template<typename CustomBinaryOp , typename OtherDerived > | |
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseBinaryOp< CustomBinaryOp, const Derived, 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 BlockXpr | block (Index startRow, Index startCol, Index blockRows, Index blockCols) |
EIGEN_DEVICE_FUNC const ConstBlockXpr | block (Index startRow, Index startCol, Index blockRows, Index blockCols) const |
This is the const version of block(Index,Index,Index,Index). */. More... | |
template<int NRows, int NCols> | |
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC FixedBlockXpr< NRows, NCols >::Type | block (Index startRow, Index startCol) |
template<int NRows, int NCols> | |
EIGEN_DEVICE_FUNC const ConstFixedBlockXpr< NRows, NCols >::Type | block (Index startRow, Index startCol) const |
This is the const version of block<>(Index, Index). */. More... | |
template<int NRows, int NCols> | |
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL FixedBlockXpr< NRows, NCols >::Type | block (Index startRow, Index startCol, Index blockRows, Index blockCols) |
template<int NRows, int NCols> | |
const ConstFixedBlockXpr< NRows, NCols >::Type | block (Index startRow, Index startCol, Index blockRows, Index blockCols) const |
This is the const version of block<>(Index, Index, Index, Index). More... | |
RealScalar | blueNorm () const |
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC BlockXpr | bottomLeftCorner (Index cRows, Index cCols) |
EIGEN_DEVICE_FUNC const ConstBlockXpr | bottomLeftCorner (Index cRows, Index cCols) const |
This is the const version of bottomLeftCorner(Index, Index). More... | |
template<int CRows, int CCols> | |
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC FixedBlockXpr< CRows, CCols >::Type | bottomLeftCorner () |
template<int CRows, int CCols> | |
EIGEN_DEVICE_FUNC const ConstFixedBlockXpr< CRows, CCols >::Type | bottomLeftCorner () const |
This is the const version of bottomLeftCorner<int, int>(). More... | |
template<int CRows, int CCols> | |
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL FixedBlockXpr< CRows, CCols >::Type | bottomLeftCorner (Index cRows, Index cCols) |
template<int CRows, int CCols> | |
const ConstFixedBlockXpr< CRows, CCols >::Type | bottomLeftCorner (Index cRows, Index cCols) const |
This is the const version of bottomLeftCorner<int, int>(Index, Index). More... | |
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC BlockXpr | bottomRightCorner (Index cRows, Index cCols) |
EIGEN_DEVICE_FUNC const ConstBlockXpr | bottomRightCorner (Index cRows, Index cCols) const |
This is the const version of bottomRightCorner(Index, Index). More... | |
template<int CRows, int CCols> | |
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC FixedBlockXpr< CRows, CCols >::Type | bottomRightCorner () |
template<int CRows, int CCols> | |
EIGEN_DEVICE_FUNC const ConstFixedBlockXpr< CRows, CCols >::Type | bottomRightCorner () const |
This is the const version of bottomRightCorner<int, int>(). More... | |
template<int CRows, int CCols> | |
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL FixedBlockXpr< CRows, CCols >::Type | bottomRightCorner (Index cRows, Index cCols) |
template<int CRows, int CCols> | |
const ConstFixedBlockXpr< CRows, CCols >::Type | bottomRightCorner (Index cRows, Index cCols) const |
This is the const version of bottomRightCorner<int, int>(Index, Index). More... | |
EIGEN_DEVICE_FUNC RowsBlockXpr | bottomRows (Index n) |
EIGEN_DEVICE_FUNC ConstRowsBlockXpr | bottomRows (Index n) const |
This is the const version of bottomRows(Index). More... | |
template<int N> | |
EIGEN_DEVICE_FUNC NRowsBlockXpr< N >::Type | bottomRows (Index n=N) |
template<int N> | |
EIGEN_DEVICE_FUNC ConstNRowsBlockXpr< N >::Type | bottomRows (Index n=N) const |
This is the const version of bottomRows<int>(). More... | |
template<typename NewType > | |
EIGEN_DEVICE_FUNC CastXpr< NewType >::Type | cast () const |
EIGEN_DEVICE_FUNC ColXpr | col (Index i) |
EIGEN_DEVICE_FUNC ConstColXpr | col (Index i) const |
This is the const version of col(). More... | |
Index | cols () const |
EIGEN_DEVICE_FUNC ConjugateReturnType | conjugate () const |
Derived & | const_cast_derived () const |
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseAbsReturnType | cwiseAbs () const |
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseAbs2ReturnType | cwiseAbs2 () const |
template<typename OtherDerived > | |
EIGEN_DEVICE_FUNC const CwiseBinaryOp< std::equal_to< Scalar >, const Derived, 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 |
template<typename OtherDerived > | |
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_max_op< Scalar, Scalar >, const Derived, 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 Derived, const ConstantReturnType > | cwiseMax (const Scalar &other) const |
template<typename OtherDerived > | |
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_min_op< Scalar, Scalar >, const Derived, 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 Derived, const ConstantReturnType > | cwiseMin (const Scalar &other) const |
template<typename OtherDerived > | |
EIGEN_DEVICE_FUNC const CwiseBinaryOp< std::not_equal_to< Scalar >, const Derived, const OtherDerived > | cwiseNotEqual (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const |
template<typename OtherDerived > | |
EIGEN_STRONG_INLINE const CwiseProductDenseReturnType< OtherDerived >::Type | cwiseProduct (const MatrixBase< OtherDerived > &other) const |
template<typename OtherDerived > | |
EIGEN_STRONG_INLINE const SparseMatrixBase< Derived >::template CwiseProductDenseReturnType< OtherDerived >::Type | cwiseProduct (const MatrixBase< OtherDerived > &other) const |
template<typename OtherDerived > | |
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_quotient_op< Scalar >, const Derived, 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 Derived & | derived () const |
Derived & | derived () |
template<typename OtherDerived > | |
internal::traits< Derived >::Scalar | dot (const MatrixBase< OtherDerived > &other) const |
template<typename OtherDerived > | |
internal::traits< Derived >::Scalar | dot (const SparseMatrixBase< OtherDerived > &other) const |
template<typename OtherDerived > | |
Scalar | dot (const MatrixBase< OtherDerived > &other) const |
template<typename OtherDerived > | |
Scalar | dot (const SparseMatrixBase< OtherDerived > &other) const |
template<typename OtherDerived > | |
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE const | EIGEN_CWISE_BINARY_RETURN_TYPE (Derived, OtherDerived, product) cwiseProduct(const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const |
const internal::eval< Derived >::type | eval () const |
EIGEN_DEVICE_FUNC SegmentReturnType | head (Index n) |
EIGEN_DEVICE_FUNC ConstSegmentReturnType | head (Index n) const |
This is the const version of head(Index). More... | |
template<int N> | |
EIGEN_DEVICE_FUNC FixedSegmentReturnType< N >::Type | head (Index n=N) |
template<int N> | |
EIGEN_DEVICE_FUNC ConstFixedSegmentReturnType< N >::Type | head (Index n=N) const |
This is the const version of head<int>(). More... | |
EIGEN_DEVICE_FUNC const ImagReturnType | imag () const |
EIGEN_DEVICE_FUNC NonConstImagReturnType | imag () |
Index | innerSize () const |
InnerVectorReturnType | innerVector (Index outer) |
const ConstInnerVectorReturnType | innerVector (Index outer) const |
InnerVectorsReturnType | innerVectors (Index outerStart, Index outerSize) |
const ConstInnerVectorsReturnType | innerVectors (Index outerStart, Index outerSize) const |
template<typename OtherDerived > | |
bool | isApprox (const SparseMatrixBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const |
template<typename OtherDerived > | |
bool | isApprox (const MatrixBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const |
bool | isRValue () const |
bool | isVector () const |
EIGEN_DEVICE_FUNC ColsBlockXpr | leftCols (Index n) |
EIGEN_DEVICE_FUNC ConstColsBlockXpr | leftCols (Index n) const |
This is the const version of leftCols(Index). More... | |
template<int N> | |
EIGEN_DEVICE_FUNC NColsBlockXpr< N >::Type | leftCols (Index n=N) |
template<int N> | |
EIGEN_DEVICE_FUNC ConstNColsBlockXpr< N >::Type | leftCols (Index n=N) const |
This is the const version of leftCols<int>(). More... | |
Derived & | markAsRValue () |
EIGEN_DEVICE_FUNC ColsBlockXpr | middleCols (Index startCol, Index numCols) |
EIGEN_DEVICE_FUNC ConstColsBlockXpr | middleCols (Index startCol, Index numCols) const |
This is the const version of middleCols(Index,Index). More... | |
template<int N> | |
EIGEN_DEVICE_FUNC NColsBlockXpr< N >::Type | middleCols (Index startCol, Index n=N) |
template<int N> | |
EIGEN_DEVICE_FUNC ConstNColsBlockXpr< N >::Type | middleCols (Index startCol, Index n=N) const |
This is the const version of middleCols<int>(). More... | |
EIGEN_DEVICE_FUNC RowsBlockXpr | middleRows (Index startRow, Index n) |
EIGEN_DEVICE_FUNC ConstRowsBlockXpr | middleRows (Index startRow, Index n) const |
This is the const version of middleRows(Index,Index). More... | |
template<int N> | |
EIGEN_DEVICE_FUNC NRowsBlockXpr< N >::Type | middleRows (Index startRow, Index n=N) |
template<int N> | |
EIGEN_DEVICE_FUNC ConstNRowsBlockXpr< N >::Type | middleRows (Index startRow, Index n=N) const |
This is the const version of middleRows<int>(). More... | |
RealScalar | norm () const |
template<typename OtherDerived > | |
EIGEN_DEVICE_FUNC const CwiseBinaryOp< internal::scalar_boolean_and_op, const Derived, const OtherDerived > | operator&& (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const |
template<typename OtherDerived > | |
const Product< Derived, OtherDerived > | operator* (const DiagonalBase< OtherDerived > &other) const |
template<typename OtherDerived > | |
const Product< Derived, OtherDerived, AliasFreeProduct > | operator* (const SparseMatrixBase< OtherDerived > &other) const |
template<typename OtherDerived > | |
const Product< Derived, OtherDerived > | operator* (const MatrixBase< OtherDerived > &other) const |
Derived & | operator*= (const Scalar &other) |
template<typename OtherDerived > | |
Derived & | operator*= (const SparseMatrixBase< OtherDerived > &other) |
template<typename OtherDerived > | |
Derived & | operator+= (const SparseMatrixBase< OtherDerived > &other) |
template<typename OtherDerived > | |
Derived & | operator+= (const DiagonalBase< OtherDerived > &other) |
template<typename OtherDerived > | |
Derived & | operator+= (const EigenBase< OtherDerived > &other) |
template<typename OtherDerived > | |
EIGEN_STRONG_INLINE Derived & | operator+= (const SparseMatrixBase< OtherDerived > &other) |
EIGEN_DEVICE_FUNC const NegativeReturnType | operator- () const |
template<typename OtherDerived > | |
Derived & | operator-= (const SparseMatrixBase< OtherDerived > &other) |
template<typename OtherDerived > | |
Derived & | operator-= (const DiagonalBase< OtherDerived > &other) |
template<typename OtherDerived > | |
Derived & | operator-= (const EigenBase< OtherDerived > &other) |
template<typename OtherDerived > | |
EIGEN_STRONG_INLINE Derived & | operator-= (const SparseMatrixBase< OtherDerived > &other) |
Derived & | operator/= (const Scalar &other) |
template<typename OtherDerived > | |
Derived & | operator= (const EigenBase< OtherDerived > &other) |
template<typename OtherDerived > | |
Derived & | operator= (const ReturnByValue< OtherDerived > &other) |
template<typename OtherDerived > | |
Derived & | operator= (const SparseMatrixBase< OtherDerived > &other) |
Derived & | operator= (const Derived &other) |
template<typename OtherDerived > | |
EIGEN_DEVICE_FUNC const CwiseBinaryOp< internal::scalar_boolean_or_op, const Derived, const OtherDerived > | operator|| (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const |
Index | outerSize () const |
const SparseView< Derived > | 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 ColsBlockXpr | rightCols (Index n) |
EIGEN_DEVICE_FUNC ConstColsBlockXpr | rightCols (Index n) const |
This is the const version of rightCols(Index). More... | |
template<int N> | |
EIGEN_DEVICE_FUNC NColsBlockXpr< N >::Type | rightCols (Index n=N) |
template<int N> | |
EIGEN_DEVICE_FUNC ConstNColsBlockXpr< N >::Type | rightCols (Index n=N) const |
This is the const version of rightCols<int>(). More... | |
EIGEN_DEVICE_FUNC RowXpr | row (Index i) |
EIGEN_DEVICE_FUNC ConstRowXpr | row (Index i) const |
This is the const version of row(). */. More... | |
Index | rows () const |
EIGEN_DEVICE_FUNC SegmentReturnType | segment (Index start, Index n) |
EIGEN_DEVICE_FUNC ConstSegmentReturnType | segment (Index start, Index n) const |
This is the const version of segment(Index,Index). More... | |
template<int N> | |
EIGEN_DEVICE_FUNC FixedSegmentReturnType< N >::Type | segment (Index start, Index n=N) |
template<int N> | |
EIGEN_DEVICE_FUNC ConstFixedSegmentReturnType< N >::Type | segment (Index start, Index n=N) const |
This is the const version of segment<int>(Index). More... | |
template<unsigned int UpLo> | |
SparseMatrixBase< Derived >::template ConstSelfAdjointViewReturnType< UpLo >::Type | selfadjointView () const |
template<unsigned int UpLo> | |
SparseMatrixBase< Derived >::template SelfAdjointViewReturnType< UpLo >::Type | selfadjointView () |
template<unsigned int UpLo> | |
ConstSelfAdjointViewReturnType< UpLo >::Type | selfadjointView () const |
template<unsigned int UpLo> | |
SelfAdjointViewReturnType< UpLo >::Type | selfadjointView () |
Index | size () const |
SparseMatrixBase () | |
RealScalar | squaredNorm () const |
Scalar | sum () const |
EIGEN_DEVICE_FUNC SegmentReturnType | tail (Index n) |
EIGEN_DEVICE_FUNC ConstSegmentReturnType | tail (Index n) const |
This is the const version of tail(Index). More... | |
template<int N> | |
EIGEN_DEVICE_FUNC FixedSegmentReturnType< N >::Type | tail (Index n=N) |
template<int N> | |
EIGEN_DEVICE_FUNC ConstFixedSegmentReturnType< N >::Type | tail (Index n=N) const |
This is the const version of tail<int>. More... | |
DenseMatrixType | toDense () const |
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC BlockXpr | topLeftCorner (Index cRows, Index cCols) |
EIGEN_DEVICE_FUNC const ConstBlockXpr | topLeftCorner (Index cRows, Index cCols) const |
This is the const version of topLeftCorner(Index, Index). More... | |
template<int CRows, int CCols> | |
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC FixedBlockXpr< CRows, CCols >::Type | topLeftCorner () |
template<int CRows, int CCols> | |
EIGEN_DEVICE_FUNC const ConstFixedBlockXpr< CRows, CCols >::Type | topLeftCorner () const |
This is the const version of topLeftCorner<int, int>(). More... | |
template<int CRows, int CCols> | |
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL FixedBlockXpr< CRows, CCols >::Type | topLeftCorner (Index cRows, Index cCols) |
template<int CRows, int CCols> | |
const ConstFixedBlockXpr< CRows, CCols >::Type | topLeftCorner (Index cRows, Index cCols) const |
This is the const version of topLeftCorner<int, int>(Index, Index). More... | |
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC BlockXpr | topRightCorner (Index cRows, Index cCols) |
EIGEN_DEVICE_FUNC const ConstBlockXpr | topRightCorner (Index cRows, Index cCols) const |
This is the const version of topRightCorner(Index, Index). More... | |
template<int CRows, int CCols> | |
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL EIGEN_DEVICE_FUNC FixedBlockXpr< CRows, CCols >::Type | topRightCorner () |
template<int CRows, int CCols> | |
EIGEN_DEVICE_FUNC const ConstFixedBlockXpr< CRows, CCols >::Type | topRightCorner () const |
This is the const version of topRightCorner<int, int>(). More... | |
template<int CRows, int CCols> | |
EIGEN_DOC_BLOCK_ADDONS_NOT_INNER_PANEL FixedBlockXpr< CRows, CCols >::Type | topRightCorner (Index cRows, Index cCols) |
template<int CRows, int CCols> | |
const ConstFixedBlockXpr< CRows, CCols >::Type | topRightCorner (Index cRows, Index cCols) const |
This is the const version of topRightCorner<int, int>(Index, Index). More... | |
EIGEN_DEVICE_FUNC RowsBlockXpr | topRows (Index n) |
EIGEN_DEVICE_FUNC ConstRowsBlockXpr | topRows (Index n) const |
This is the const version of topRows(Index). More... | |
template<int N> | |
EIGEN_DEVICE_FUNC NRowsBlockXpr< N >::Type | topRows (Index n=N) |
template<int N> | |
EIGEN_DEVICE_FUNC ConstNRowsBlockXpr< N >::Type | topRows (Index n=N) const |
This is the const version of topRows<int>(). More... | |
TransposeReturnType | transpose () |
const ConstTransposeReturnType | transpose () const |
template<int Mode> | |
const TriangularView< const Derived, Mode > | triangularView () const |
SparseSymmetricPermutationProduct< Derived, Upper|Lower > | twistedBy (const PermutationMatrix< Dynamic, Dynamic, StorageIndex > &perm) const |
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 |
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 Index | cols () const |
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 Index | rows () const |
EIGEN_DEVICE_FUNC Index | size () const |
template<typename Dest > | |
EIGEN_DEVICE_FUNC void | subTo (Dest &dst) const |
Protected Member Functions | |
template<typename OtherDerived > | |
Derived & | assign (const OtherDerived &other) |
template<typename OtherDerived > | |
void | assignGeneric (const OtherDerived &other) |
Static Protected Member Functions | |
static StorageIndex | convert_index (const Index idx) |
Protected Attributes | |
bool | m_isRValue |
Private Member Functions | |
template<typename Dest > | |
void | evalTo (Dest &) const |
Friends | |
template<typename OtherDerived > | |
const Product< OtherDerived, Derived > | operator* (const DiagonalBase< OtherDerived > &lhs, const SparseMatrixBase &rhs) |
template<typename OtherDerived > | |
const Product< OtherDerived, Derived > | operator* (const MatrixBase< OtherDerived > &lhs, const SparseMatrixBase &rhs) |
std::ostream & | operator<< (std::ostream &s, const SparseMatrixBase &m) |
Base class of any sparse matrices or sparse expressions.
Derived | is the derived type, e.g. a sparse matrix type, or an expression, etc. |
This class can be extended with the help of the plugin mechanism described on the page TopicCustomizing_Plugins by defining the preprocessor symbol EIGEN_SPARSEMATRIXBASE_PLUGIN
.
Definition at line 281 of file ForwardDeclarations.h.
typedef internal::conditional<NumTraits<Scalar>::IsComplex, CwiseUnaryOp<internal::scalar_conjugate_op<Scalar>, Eigen::Transpose<const Derived> >, Transpose<const Derived> >::type Eigen::SparseMatrixBase< Derived >::AdjointReturnType |
Definition at line 109 of file SparseMatrixBase.h.
typedef EigenBase<Derived> Eigen::SparseMatrixBase< Derived >::Base |
Definition at line 143 of file SparseMatrixBase.h.
typedef Block<Derived> Eigen::SparseMatrixBase< Derived >::BlockXpr |
Definition at line 33 of file SparseMatrixBase.h.
typedef internal::conditional<_HasDirectAccess, const Scalar&, Scalar>::type Eigen::SparseMatrixBase< Derived >::CoeffReturnType |
Definition at line 127 of file SparseMatrixBase.h.
typedef Block<Derived, internal::traits<Derived>::RowsAtCompileTime, Dynamic, !IsRowMajor> Eigen::SparseMatrixBase< Derived >::ColsBlockXpr |
Definition at line 21 of file SparseMatrixBase.h.
typedef Block<Derived, internal::traits<Derived>::RowsAtCompileTime, 1, !IsRowMajor> Eigen::SparseMatrixBase< Derived >::ColXpr |
Definition at line 15 of file SparseMatrixBase.h.
typedef internal::conditional<NumTraits<Scalar>::IsComplex, const CwiseUnaryOp<internal::scalar_conjugate_op<Scalar>, const Derived>, const Derived& >::type Eigen::SparseMatrixBase< Derived >::ConjugateReturnType |
Definition at line 20 of file SparseMatrixBase.h.
typedef CwiseNullaryOp<internal::scalar_constant_op<Scalar>,Matrix<Scalar,Dynamic,Dynamic> > Eigen::SparseMatrixBase< Derived >::ConstantReturnType |
Definition at line 130 of file SparseMatrixBase.h.
typedef const Block<const Derived> Eigen::SparseMatrixBase< Derived >::ConstBlockXpr |
Definition at line 34 of file SparseMatrixBase.h.
typedef const Block<const Derived, internal::traits<Derived>::RowsAtCompileTime, Dynamic, !IsRowMajor> Eigen::SparseMatrixBase< Derived >::ConstColsBlockXpr |
Definition at line 22 of file SparseMatrixBase.h.
typedef const Block<const Derived, internal::traits<Derived>::RowsAtCompileTime, 1, !IsRowMajor> Eigen::SparseMatrixBase< Derived >::ConstColXpr |
Definition at line 16 of file SparseMatrixBase.h.
typedef Block<const Derived,IsRowMajor?1:Dynamic,IsRowMajor?Dynamic:1,true> Eigen::SparseMatrixBase< Derived >::ConstInnerVectorReturnType |
Definition at line 355 of file SparseMatrixBase.h.
typedef Block<const Derived,Dynamic,Dynamic,true> Eigen::SparseMatrixBase< Derived >::ConstInnerVectorsReturnType |
Definition at line 361 of file SparseMatrixBase.h.
typedef const Block<const Derived, Dynamic, internal::traits<Derived>::ColsAtCompileTime, IsRowMajor> Eigen::SparseMatrixBase< Derived >::ConstRowsBlockXpr |
Definition at line 25 of file SparseMatrixBase.h.
typedef const Block<const Derived, 1, internal::traits<Derived>::ColsAtCompileTime, IsRowMajor> Eigen::SparseMatrixBase< Derived >::ConstRowXpr |
Definition at line 19 of file SparseMatrixBase.h.
typedef const VectorBlock<const Derived> Eigen::SparseMatrixBase< Derived >::ConstSegmentReturnType |
Definition at line 40 of file SparseMatrixBase.h.
typedef internal::add_const<Transpose<const Derived> >::type Eigen::SparseMatrixBase< Derived >::ConstTransposeReturnType |
Definition at line 111 of file SparseMatrixBase.h.
typedef CwiseUnaryOp<internal::scalar_abs2_op<Scalar>, const Derived> Eigen::SparseMatrixBase< Derived >::CwiseAbs2ReturnType |
Definition at line 17 of file SparseMatrixBase.h.
typedef CwiseUnaryOp<internal::scalar_abs_op<Scalar>, const Derived> Eigen::SparseMatrixBase< Derived >::CwiseAbsReturnType |
Definition at line 16 of file SparseMatrixBase.h.
typedef CwiseUnaryOp<internal::scalar_inverse_op<Scalar>, const Derived> Eigen::SparseMatrixBase< Derived >::CwiseInverseReturnType |
Definition at line 20 of file SparseMatrixBase.h.
typedef CwiseBinaryOp<internal::scalar_cmp_op<Scalar,Scalar,internal::cmp_EQ>, const Derived, const ConstantReturnType> Eigen::SparseMatrixBase< Derived >::CwiseScalarEqualReturnType |
Definition at line 137 of file SparseMatrixBase.h.
typedef CwiseUnaryOp<internal::scalar_sign_op<Scalar>, const Derived> Eigen::SparseMatrixBase< Derived >::CwiseSignReturnType |
Definition at line 19 of file SparseMatrixBase.h.
typedef CwiseUnaryOp<internal::scalar_sqrt_op<Scalar>, const Derived> Eigen::SparseMatrixBase< Derived >::CwiseSqrtReturnType |
Definition at line 18 of file SparseMatrixBase.h.
typedef Matrix<Scalar,RowsAtCompileTime,ColsAtCompileTime> Eigen::SparseMatrixBase< Derived >::DenseMatrixType |
type of the equivalent dense matrix
Definition at line 133 of file SparseMatrixBase.h.
typedef CwiseUnaryOp<internal::scalar_imag_op<Scalar>, const Derived> Eigen::SparseMatrixBase< Derived >::ImagReturnType |
Definition at line 32 of file SparseMatrixBase.h.
typedef Matrix<StorageIndex,Dynamic,1> Eigen::SparseMatrixBase< Derived >::IndexVector |
Definition at line 51 of file SparseMatrixBase.h.
typedef Block<Derived,IsRowMajor?1:Dynamic,IsRowMajor?Dynamic:1,true> Eigen::SparseMatrixBase< Derived >::InnerVectorReturnType |
Definition at line 354 of file SparseMatrixBase.h.
typedef Block<Derived,Dynamic,Dynamic,true> Eigen::SparseMatrixBase< Derived >::InnerVectorsReturnType |
Definition at line 360 of file SparseMatrixBase.h.
typedef CwiseUnaryOp<internal::scalar_opposite_op<Scalar>, const Derived> Eigen::SparseMatrixBase< Derived >::NegativeReturnType |
Definition at line 36 of file SparseMatrixBase.h.
typedef CwiseUnaryView<internal::scalar_imag_ref_op<Scalar>, Derived> Eigen::SparseMatrixBase< Derived >::NonConstImagReturnType |
Definition at line 34 of file SparseMatrixBase.h.
typedef internal::conditional<NumTraits<Scalar>::IsComplex, CwiseUnaryView<internal::scalar_real_ref_op<Scalar>, Derived>, Derived& >::type Eigen::SparseMatrixBase< Derived >::NonConstRealReturnType |
Definition at line 30 of file SparseMatrixBase.h.
typedef internal::add_const_on_value_type_if_arithmetic< typename internal::packet_traits<Scalar>::type >::type Eigen::SparseMatrixBase< Derived >::PacketReturnType |
Definition at line 47 of file SparseMatrixBase.h.
typedef internal::packet_traits<Scalar>::type Eigen::SparseMatrixBase< Derived >::PacketScalar |
Definition at line 38 of file SparseMatrixBase.h.
typedef SparseMatrix<Scalar, Flags&RowMajorBit ? RowMajor : ColMajor, StorageIndex> Eigen::SparseMatrixBase< Derived >::PlainObject |
Definition at line 114 of file SparseMatrixBase.h.
typedef internal::conditional<NumTraits<Scalar>::IsComplex, const CwiseUnaryOp<internal::scalar_real_op<Scalar>, const Derived>, const Derived& >::type Eigen::SparseMatrixBase< Derived >::RealReturnType |
Definition at line 25 of file SparseMatrixBase.h.
typedef NumTraits<Scalar>::Real Eigen::SparseMatrixBase< Derived >::RealScalar |
This is the "real scalar" type; if the Scalar type is already real numbers (e.g. int, float or double) then RealScalar is just the same as Scalar. If Scalar is std::complex<T> then RealScalar is T.
Definition at line 123 of file SparseMatrixBase.h.
typedef Block<Derived, Dynamic, internal::traits<Derived>::ColsAtCompileTime, IsRowMajor> Eigen::SparseMatrixBase< Derived >::RowsBlockXpr |
Definition at line 24 of file SparseMatrixBase.h.
typedef Block<Derived, 1, internal::traits<Derived>::ColsAtCompileTime, IsRowMajor> Eigen::SparseMatrixBase< Derived >::RowXpr |
Definition at line 18 of file SparseMatrixBase.h.
typedef internal::traits<Derived>::Scalar Eigen::SparseMatrixBase< Derived >::Scalar |
Definition at line 31 of file SparseMatrixBase.h.
typedef Matrix<Scalar,Dynamic,1> Eigen::SparseMatrixBase< Derived >::ScalarVector |
Definition at line 52 of file SparseMatrixBase.h.
typedef VectorBlock<Derived> Eigen::SparseMatrixBase< Derived >::SegmentReturnType |
Definition at line 39 of file SparseMatrixBase.h.
typedef Matrix<Scalar,EIGEN_SIZE_MAX(RowsAtCompileTime,ColsAtCompileTime), EIGEN_SIZE_MAX(RowsAtCompileTime,ColsAtCompileTime)> Eigen::SparseMatrixBase< Derived >::SquareMatrixType |
type of the equivalent square matrix
Definition at line 136 of file SparseMatrixBase.h.
typedef SparseMatrixBase Eigen::SparseMatrixBase< Derived >::StorageBaseType |
Definition at line 49 of file SparseMatrixBase.h.
typedef internal::traits<Derived>::StorageIndex Eigen::SparseMatrixBase< Derived >::StorageIndex |
The integer type used to store indices within a SparseMatrix. For a SparseMatrix<Scalar,Options,IndexType>
it an alias of the third template parameter IndexType
.
Definition at line 43 of file SparseMatrixBase.h.
typedef internal::traits<Derived>::StorageKind Eigen::SparseMatrixBase< Derived >::StorageKind |
Definition at line 39 of file SparseMatrixBase.h.
typedef Transpose<Derived> Eigen::SparseMatrixBase< Derived >::TransposeReturnType |
Definition at line 110 of file SparseMatrixBase.h.
typedef Scalar Eigen::SparseMatrixBase< Derived >::value_type |
The numeric type of the expression' coefficients, e.g. float, double, int or std::complex<float>, etc.
It is an alias for the Scalar type
Definition at line 36 of file SparseMatrixBase.h.
anonymous enum |
Enumerator | |
---|---|
RowsAtCompileTime |
The number of rows at compile-time. This is just a copy of the value provided by the Derived type. If a value is not known at compile-time, it is set to the Dynamic constant.
|
ColsAtCompileTime |
The number of columns at compile-time. This is just a copy of the value provided by the Derived type. If a value is not known at compile-time, it is set to the Dynamic constant.
|
SizeAtCompileTime |
This is equal to the number of coefficients, i.e. the number of rows times the number of columns, or to Dynamic if this is not known at compile-time.
|
MaxRowsAtCompileTime | |
MaxColsAtCompileTime | |
MaxSizeAtCompileTime | |
IsVectorAtCompileTime |
This is set to true if either the number of rows or the number of columns is known at compile-time to be equal to 1. Indeed, in that case, we are dealing with a column-vector (if there is only one column) or with a row-vector (if there is only one row). |
Flags |
This stores expression Flags flags which may or may not be inherited by new expressions constructed from this one. See the list of flags. |
IsRowMajor | |
InnerSizeAtCompileTime | |
_HasDirectAccess |
Definition at line 57 of file SparseMatrixBase.h.
|
inline |
Definition at line 192 of file SparseMatrixBase.h.
|
inline |
Definition at line 351 of file SparseMatrixBase.h.
|
inlineprotected |
|
inlineprotected |
|
inline |
*this
and other *this
and other The template parameter CustomBinaryOp is the type of the functor of the custom operator (see class CwiseBinaryOp for an example)
Here is an example illustrating the use of custom functors:
Output:
Definition at line 44 of file SparseMatrixBase.h.
|
inline |
startRow | the first row in the block |
startCol | the first column in the block |
blockRows | the number of rows in the block |
blockCols | the number of columns in the block |
Example:
Output:
Definition at line 65 of file SparseMatrixBase.h.
|
inline |
This is the const version of block(Index,Index,Index,Index). */.
Definition at line 72 of file SparseMatrixBase.h.
|
inline |
The template parameters NRows and NCols are the number of rows and columns in the block.
startRow | the first row in the block |
startCol | the first column in the block |
Example:
Output:
Definition at line 781 of file SparseMatrixBase.h.
|
inline |
This is the const version of block<>(Index, Index). */.
Definition at line 789 of file SparseMatrixBase.h.
|
inline |
NRows | number of rows in block as specified at compile-time |
NCols | number of columns in block as specified at compile-time |
startRow | the first row in the block |
startCol | the first column in the block |
blockRows | number of rows in block as specified at run-time |
blockCols | number of columns in block as specified at run-time |
This function is mainly useful for blocks where the number of rows is specified at compile-time and the number of columns is specified at run-time, or vice versa. The compile-time and run-time information should not contradict. In other words, blockRows should equal NRows unless NRows is Dynamic, and the same for the number of columns.
Example:
Output:
Definition at line 816 of file SparseMatrixBase.h.
|
inline |
This is the const version of block<>(Index, Index, Index, Index).
Definition at line 824 of file SparseMatrixBase.h.
|
inline |
Definition at line 92 of file SparseDot.h.
|
inline |
cRows | the number of rows in the corner |
cCols | the number of columns in the corner |
Example:
Output:
Definition at line 349 of file SparseMatrixBase.h.
|
inline |
This is the const version of bottomLeftCorner(Index, Index).
Definition at line 356 of file SparseMatrixBase.h.
|
inline |
The template parameters CRows and CCols are the number of rows and columns in the corner.
Example:
Output:
Definition at line 374 of file SparseMatrixBase.h.
|
inline |
This is the const version of bottomLeftCorner<int, int>().
Definition at line 382 of file SparseMatrixBase.h.
|
inline |
CRows | number of rows in corner as specified at compile-time |
CCols | number of columns in corner as specified at compile-time |
cRows | number of rows in corner as specified at run-time |
cCols | number of columns in corner as specified at run-time |
This function is mainly useful for corners where the number of rows is specified at compile-time and the number of columns is specified at run-time, or vice versa. The compile-time and run-time information should not contradict. In other words, cRows should equal CRows unless CRows is Dynamic, and the same for the number of columns.
Example:
Output:
Definition at line 407 of file SparseMatrixBase.h.
|
inline |
This is the const version of bottomLeftCorner<int, int>(Index, Index).
Definition at line 414 of file SparseMatrixBase.h.
|
inline |
cRows | the number of rows in the corner |
cCols | the number of columns in the corner |
Example:
Output:
Definition at line 264 of file SparseMatrixBase.h.
|
inline |
This is the const version of bottomRightCorner(Index, Index).
Definition at line 271 of file SparseMatrixBase.h.
|
inline |
The template parameters CRows and CCols are the number of rows and columns in the corner.
Example:
Output:
Definition at line 289 of file SparseMatrixBase.h.
|
inline |
This is the const version of bottomRightCorner<int, int>().
Definition at line 297 of file SparseMatrixBase.h.
|
inline |
CRows | number of rows in corner as specified at compile-time |
CCols | number of columns in corner as specified at compile-time |
cRows | number of rows in corner as specified at run-time |
cCols | number of columns in corner as specified at run-time |
This function is mainly useful for corners where the number of rows is specified at compile-time and the number of columns is specified at run-time, or vice versa. The compile-time and run-time information should not contradict. In other words, cRows should equal CRows unless CRows is Dynamic, and the same for the number of columns.
Example:
Output:
Definition at line 322 of file SparseMatrixBase.h.
|
inline |
This is the const version of bottomRightCorner<int, int>(Index, Index).
Definition at line 329 of file SparseMatrixBase.h.
|
inline |
n | the number of rows in the block |
Example:
Output:
Definition at line 489 of file SparseMatrixBase.h.
|
inline |
This is the const version of bottomRows(Index).
Definition at line 496 of file SparseMatrixBase.h.
|
inline |
N | the number of rows in the block as specified at compile-time |
n | the number of rows in the block as specified at run-time |
The compile-time and run-time information should not contradict. In other words, n should equal N unless N is Dynamic.
Example:
Output:
Definition at line 518 of file SparseMatrixBase.h.
|
inline |
This is the const version of bottomRows<int>().
Definition at line 526 of file SparseMatrixBase.h.
|
inline |
*this
with the Scalar type casted to NewScalar.The template parameter NewScalar is the type we are casting the scalars to.
Definition at line 63 of file SparseMatrixBase.h.
|
inline |
Example:
Output:
Definition at line 839 of file SparseMatrixBase.h.
|
inline |
This is the const version of col().
Definition at line 846 of file SparseMatrixBase.h.
|
inline |
|
inline |
*this
.Definition at line 75 of file SparseMatrixBase.h.
|
inline |
Definition at line 140 of file SparseMatrixBase.h.
|
inlinestaticprotected |
Definition at line 396 of file SparseMatrixBase.h.
|
inline |
*this
Example:
Output:
Definition at line 33 of file SparseMatrixBase.h.
|
inline |
*this
Example:
Output:
Definition at line 46 of file SparseMatrixBase.h.
|
inline |
Example:
Output:
Definition at line 44 of file SparseMatrixBase.h.
|
inline |
*this
and a scalar s Definition at line 150 of file SparseMatrixBase.h.
|
inline |
Example:
Output:
Definition at line 84 of file SparseMatrixBase.h.
|
inline |
Example:
Output:
Definition at line 105 of file SparseMatrixBase.h.
|
inline |
Definition at line 116 of file SparseMatrixBase.h.
|
inline |
Example:
Output:
Definition at line 79 of file SparseMatrixBase.h.
|
inline |
Definition at line 90 of file SparseMatrixBase.h.
|
inline |
Example:
Output:
Definition at line 64 of file SparseMatrixBase.h.
EIGEN_STRONG_INLINE const CwiseProductDenseReturnType<OtherDerived>::Type Eigen::SparseMatrixBase< Derived >::cwiseProduct | ( | const MatrixBase< OtherDerived > & | other | ) | const |
EIGEN_STRONG_INLINE const SparseMatrixBase<Derived>::template CwiseProductDenseReturnType<OtherDerived>::Type Eigen::SparseMatrixBase< Derived >::cwiseProduct | ( | const MatrixBase< OtherDerived > & | other | ) | const |
Definition at line 691 of file SparseCwiseBinaryOp.h.
|
inline |
Example:
Output:
Definition at line 132 of file SparseMatrixBase.h.
|
inline |
Example:
Output:
Definition at line 70 of file SparseMatrixBase.h.
|
inline |
Example:
Output:
Definition at line 59 of file SparseMatrixBase.h.
|
inline |
Definition at line 138 of file SparseMatrixBase.h.
|
inline |
Definition at line 139 of file SparseMatrixBase.h.
internal::traits<Derived>::Scalar Eigen::SparseMatrixBase< Derived >::dot | ( | const MatrixBase< OtherDerived > & | other | ) | const |
Definition at line 18 of file SparseDot.h.
internal::traits<Derived>::Scalar Eigen::SparseMatrixBase< Derived >::dot | ( | const SparseMatrixBase< OtherDerived > & | other | ) | const |
Definition at line 43 of file SparseDot.h.
Scalar Eigen::SparseMatrixBase< Derived >::dot | ( | const MatrixBase< OtherDerived > & | other | ) | const |
Scalar Eigen::SparseMatrixBase< Derived >::dot | ( | const SparseMatrixBase< OtherDerived > & | other | ) | const |
|
inline |
Example:
Output:
Definition at line 23 of file SparseMatrixBase.h.
|
inline |
Notice that in the case of a plain matrix or vector (not an expression) this function just returns a const reference, in order to avoid a useless copy.
Definition at line 384 of file SparseMatrixBase.h.
|
private |
|
inline |
n | the number of coefficients in the segment |
Example:
Output:
Definition at line 920 of file SparseMatrixBase.h.
|
inline |
This is the const version of head(Index).
Definition at line 928 of file SparseMatrixBase.h.
|
inline |
N | the number of coefficients in the segment as specified at compile-time |
n | the number of coefficients in the segment as specified at run-time |
The compile-time and run-time information should not contradict. In other words, n should equal N unless N is Dynamic.
Example:
Output:
Definition at line 1014 of file SparseMatrixBase.h.
|
inline |
This is the const version of head<int>().
Definition at line 1023 of file SparseMatrixBase.h.
|
inline |
*this
.Definition at line 96 of file SparseMatrixBase.h.
|
inline |
*this
.Definition at line 164 of file SparseMatrixBase.h.
|
inline |
Definition at line 187 of file SparseMatrixBase.h.
SparseMatrixBase< Derived >::InnerVectorReturnType Eigen::SparseMatrixBase< Derived >::innerVector | ( | Index | outer | ) |
*this
if *this
is col-major (resp. row-major). Definition at line 333 of file SparseBlock.h.
const SparseMatrixBase< Derived >::ConstInnerVectorReturnType Eigen::SparseMatrixBase< Derived >::innerVector | ( | Index | outer | ) | const |
*this
if *this
is col-major (resp. row-major). Read-only. Definition at line 340 of file SparseBlock.h.
SparseMatrixBase< Derived >::InnerVectorsReturnType Eigen::SparseMatrixBase< Derived >::innerVectors | ( | Index | outerStart, |
Index | outerSize | ||
) |
*this
if *this
is col-major (resp. row-major). Definition at line 348 of file SparseBlock.h.
const SparseMatrixBase< Derived >::ConstInnerVectorsReturnType Eigen::SparseMatrixBase< Derived >::innerVectors | ( | Index | outerStart, |
Index | outerSize | ||
) | const |
*this
if *this
is col-major (resp. row-major). Read-only. Definition at line 361 of file SparseBlock.h.
bool Eigen::SparseMatrixBase< Derived >::isApprox | ( | const SparseMatrixBase< OtherDerived > & | other, |
const RealScalar & | prec = NumTraits<Scalar>::dummy_precision() |
||
) | const |
Definition at line 17 of file SparseFuzzy.h.
|
inline |
Definition at line 375 of file SparseMatrixBase.h.
|
inline |
Definition at line 189 of file SparseMatrixBase.h.
|
inline |
Definition at line 181 of file SparseMatrixBase.h.
|
inline |
n | the number of columns in the block |
Example:
Output:
Definition at line 603 of file SparseMatrixBase.h.
|
inline |
This is the const version of leftCols(Index).
Definition at line 610 of file SparseMatrixBase.h.
|
inline |
N | the number of columns in the block as specified at compile-time |
n | the number of columns in the block as specified at run-time |
The compile-time and run-time information should not contradict. In other words, n should equal N unless N is Dynamic.
Example:
Output:
Definition at line 632 of file SparseMatrixBase.h.
|
inline |
This is the const version of leftCols<int>().
Definition at line 640 of file SparseMatrixBase.h.
|
inline |
Definition at line 190 of file SparseMatrixBase.h.
|
inline |
startCol | the index of the first column in the block |
numCols | the number of columns in the block |
Example:
Output:
Definition at line 716 of file SparseMatrixBase.h.
|
inline |
This is the const version of middleCols(Index,Index).
Definition at line 723 of file SparseMatrixBase.h.
|
inline |
N | the number of columns in the block as specified at compile-time |
startCol | the index of the first column in the block |
n | the number of columns in the block as specified at run-time |
The compile-time and run-time information should not contradict. In other words, n should equal N unless N is Dynamic.
Example:
Output:
Definition at line 746 of file SparseMatrixBase.h.
|
inline |
This is the const version of middleCols<int>().
Definition at line 754 of file SparseMatrixBase.h.
|
inline |
startRow | the index of the first row in the block |
n | the number of rows in the block |
Example:
Output:
Definition at line 546 of file SparseMatrixBase.h.
|
inline |
This is the const version of middleRows(Index,Index).
Definition at line 553 of file SparseMatrixBase.h.
|
inline |
N | the number of rows in the block as specified at compile-time |
startRow | the index of the first row in the block |
n | the number of rows in the block as specified at run-time |
The compile-time and run-time information should not contradict. In other words, n should equal N unless N is Dynamic.
Example:
Output:
Definition at line 576 of file SparseMatrixBase.h.
|
inline |
This is the const version of middleRows<int>().
Definition at line 584 of file SparseMatrixBase.h.
|
inline |
Definition at line 84 of file SparseDot.h.
|
inline |
*this
and other Example:
Output:
Definition at line 92 of file SparseMatrixBase.h.
|
inline |
Definition at line 297 of file SparseMatrixBase.h.
|
inline |
ref
is a meaningful non zero reference value. Definition at line 29 of file SparseProduct.h.
|
inline |
Definition at line 314 of file SparseMatrixBase.h.
EIGEN_STRONG_INLINE Derived & Eigen::SparseMatrixBase< Derived >::operator*= | ( | const Scalar & | other | ) |
Definition at line 124 of file SparseCwiseUnaryOp.h.
Derived& Eigen::SparseMatrixBase< Derived >::operator*= | ( | const SparseMatrixBase< OtherDerived > & | other | ) |
Derived& Eigen::SparseMatrixBase< Derived >::operator+= | ( | const SparseMatrixBase< OtherDerived > & | other | ) |
Derived & Eigen::SparseMatrixBase< Derived >::operator+= | ( | const DiagonalBase< OtherDerived > & | other | ) |
Definition at line 674 of file SparseCwiseBinaryOp.h.
Derived & Eigen::SparseMatrixBase< Derived >::operator+= | ( | const EigenBase< OtherDerived > & | other | ) |
Definition at line 642 of file SparseCwiseBinaryOp.h.
EIGEN_STRONG_INLINE Derived& Eigen::SparseMatrixBase< Derived >::operator+= | ( | const SparseMatrixBase< OtherDerived > & | other | ) |
Definition at line 667 of file SparseCwiseBinaryOp.h.
|
inline |
*this
Definition at line 46 of file SparseMatrixBase.h.
Derived& Eigen::SparseMatrixBase< Derived >::operator-= | ( | const SparseMatrixBase< OtherDerived > & | other | ) |
Derived & Eigen::SparseMatrixBase< Derived >::operator-= | ( | const DiagonalBase< OtherDerived > & | other | ) |
Definition at line 682 of file SparseCwiseBinaryOp.h.
Derived & Eigen::SparseMatrixBase< Derived >::operator-= | ( | const EigenBase< OtherDerived > & | other | ) |
Definition at line 650 of file SparseCwiseBinaryOp.h.
EIGEN_STRONG_INLINE Derived& Eigen::SparseMatrixBase< Derived >::operator-= | ( | const SparseMatrixBase< OtherDerived > & | other | ) |
Definition at line 659 of file SparseCwiseBinaryOp.h.
EIGEN_STRONG_INLINE Derived & Eigen::SparseMatrixBase< Derived >::operator/= | ( | const Scalar & | other | ) |
Definition at line 136 of file SparseCwiseUnaryOp.h.
Derived & Eigen::SparseMatrixBase< Derived >::operator= | ( | const EigenBase< OtherDerived > & | other | ) |
Definition at line 17 of file SparseAssign.h.
Derived & Eigen::SparseMatrixBase< Derived >::operator= | ( | const ReturnByValue< OtherDerived > & | other | ) |
Definition at line 25 of file SparseAssign.h.
|
inline |
Definition at line 34 of file SparseAssign.h.
|
inline |
Definition at line 43 of file SparseAssign.h.
|
inline |
*this
and other Example:
Output:
Definition at line 111 of file SparseMatrixBase.h.
|
inline |
Definition at line 184 of file SparseMatrixBase.h.
|
inline |
*this
with values smaller than reference * epsilon removed.This method is typically used in conjunction with the product of two sparse matrices to automatically prune the smallest values as follows:
where ref
is a meaningful non zero reference value.
Definition at line 245 of file SparseView.h.
|
inline |
*this
.Definition at line 87 of file SparseMatrixBase.h.
|
inline |
*this
.Definition at line 155 of file SparseMatrixBase.h.
|
inline |
n | the number of columns in the block |
Example:
Output:
Definition at line 659 of file SparseMatrixBase.h.
|
inline |
This is the const version of rightCols(Index).
Definition at line 666 of file SparseMatrixBase.h.
|
inline |
N | the number of columns in the block as specified at compile-time |
n | the number of columns in the block as specified at run-time |
The compile-time and run-time information should not contradict. In other words, n should equal N unless N is Dynamic.
Example:
Output:
Definition at line 688 of file SparseMatrixBase.h.
|
inline |
This is the const version of rightCols<int>().
Definition at line 696 of file SparseMatrixBase.h.
|
inline |
Example:
Output:
Definition at line 860 of file SparseMatrixBase.h.
|
inline |
This is the const version of row(). */.
Definition at line 867 of file SparseMatrixBase.h.
|
inline |
|
inline |
start | the first coefficient in the segment |
n | the number of coefficients in the segment |
Example:
Output:
Definition at line 889 of file SparseMatrixBase.h.
|
inline |
This is the const version of segment(Index,Index).
Definition at line 898 of file SparseMatrixBase.h.
|
inline |
*this
N | the number of coefficients in the segment as specified at compile-time |
start | the index of the first element in the segment |
n | the number of coefficients in the segment as specified at compile-time |
The compile-time and run-time information should not contradict. In other words, n should equal N unless N is Dynamic.
Example:
Output:
Definition at line 982 of file SparseMatrixBase.h.
|
inline |
This is the const version of segment<int>(Index).
Definition at line 991 of file SparseMatrixBase.h.
SparseMatrixBase<Derived>::template ConstSelfAdjointViewReturnType<UpLo>::Type Eigen::SparseMatrixBase< Derived >::selfadjointView | ( | ) | const |
Definition at line 175 of file SparseSelfAdjointView.h.
SparseMatrixBase<Derived>::template SelfAdjointViewReturnType<UpLo>::Type Eigen::SparseMatrixBase< Derived >::selfadjointView | ( | ) |
Definition at line 182 of file SparseSelfAdjointView.h.
|
inline |
|
inline |
|
inline |
Definition at line 176 of file SparseMatrixBase.h.
|
inline |
Definition at line 77 of file SparseDot.h.
internal::traits< Derived >::Scalar Eigen::SparseMatrixBase< Derived >::sum | ( | ) | const |
Definition at line 17 of file SparseRedux.h.
|
inline |
n | the number of coefficients in the segment |
Example:
Output:
Definition at line 950 of file SparseMatrixBase.h.
|
inline |
This is the const version of tail(Index).
Definition at line 958 of file SparseMatrixBase.h.
|
inline |
N | the number of coefficients in the segment as specified at compile-time |
n | the number of coefficients in the segment as specified at run-time |
The compile-time and run-time information should not contradict. In other words, n should equal N unless N is Dynamic.
Example:
Output:
Definition at line 1046 of file SparseMatrixBase.h.
|
inline |
This is the const version of tail<int>.
Definition at line 1055 of file SparseMatrixBase.h.
|
inline |
Definition at line 365 of file SparseMatrixBase.h.
|
inline |
cRows | the number of rows in the corner |
cCols | the number of columns in the corner |
Example:
Output:
Definition at line 179 of file SparseMatrixBase.h.
|
inline |
This is the const version of topLeftCorner(Index, Index).
Definition at line 186 of file SparseMatrixBase.h.
|
inline |
The template parameters CRows and CCols are the number of rows and columns in the corner.
Example:
Output:
Definition at line 204 of file SparseMatrixBase.h.
|
inline |
This is the const version of topLeftCorner<int, int>().
Definition at line 212 of file SparseMatrixBase.h.
|
inline |
CRows | number of rows in corner as specified at compile-time |
CCols | number of columns in corner as specified at compile-time |
cRows | number of rows in corner as specified at run-time |
cCols | number of columns in corner as specified at run-time |
This function is mainly useful for corners where the number of rows is specified at compile-time and the number of columns is specified at run-time, or vice versa. The compile-time and run-time information should not contradict. In other words, cRows should equal CRows unless CRows is Dynamic, and the same for the number of columns.
Example:
Output:
Definition at line 237 of file SparseMatrixBase.h.
|
inline |
This is the const version of topLeftCorner<int, int>(Index, Index).
Definition at line 244 of file SparseMatrixBase.h.
|
inline |
cRows | the number of rows in the corner |
cCols | the number of columns in the corner |
Example:
Output:
Definition at line 93 of file SparseMatrixBase.h.
|
inline |
This is the const version of topRightCorner(Index, Index).
Definition at line 100 of file SparseMatrixBase.h.
|
inline |
CRows | the number of rows in the corner |
CCols | the number of columns in the corner |
Example:
Output:
Definition at line 119 of file SparseMatrixBase.h.
|
inline |
This is the const version of topRightCorner<int, int>().
Definition at line 127 of file SparseMatrixBase.h.
|
inline |
CRows | number of rows in corner as specified at compile-time |
CCols | number of columns in corner as specified at compile-time |
cRows | number of rows in corner as specified at run-time |
cCols | number of columns in corner as specified at run-time |
This function is mainly useful for corners where the number of rows is specified at compile-time and the number of columns is specified at run-time, or vice versa. The compile-time and run-time information should not contradict. In other words, cRows should equal CRows unless CRows is Dynamic, and the same for the number of columns.
Example:
Output:
Definition at line 152 of file SparseMatrixBase.h.
|
inline |
This is the const version of topRightCorner<int, int>(Index, Index).
Definition at line 159 of file SparseMatrixBase.h.
|
inline |
n | the number of rows in the block |
Example:
Output:
Definition at line 433 of file SparseMatrixBase.h.
|
inline |
This is the const version of topRows(Index).
Definition at line 440 of file SparseMatrixBase.h.
|
inline |
N | the number of rows in the block as specified at compile-time |
n | the number of rows in the block as specified at run-time |
The compile-time and run-time information should not contradict. In other words, n should equal N unless N is Dynamic.
Example:
Output:
Definition at line 462 of file SparseMatrixBase.h.
|
inline |
This is the const version of topRows<int>().
Definition at line 470 of file SparseMatrixBase.h.
|
inline |
Definition at line 349 of file SparseMatrixBase.h.
|
inline |
Definition at line 350 of file SparseMatrixBase.h.
|
inline |
Definition at line 182 of file SparseTriangularView.h.
|
inline |
*this
Definition at line 324 of file SparseMatrixBase.h.
|
inline |
Apply a unary operator coefficient-wise.
[in] | func | Functor implementing the unary operator |
CustomUnaryOp | Type of func |
The function ptr_fun()
from the C++ standard library can be used to make functors out of normal functions.
Example:
Output:
Genuine functors allow for more possibilities, for instance it may contain a state.
Example:
Output:
Definition at line 122 of file SparseMatrixBase.h.
|
inline |
The template parameter CustomUnaryOp is the type of the functor of the custom unary operator.
Example:
Output:
Definition at line 143 of file SparseMatrixBase.h.
|
friend |
Definition at line 303 of file SparseMatrixBase.h.
|
friend |
Definition at line 320 of file SparseMatrixBase.h.
|
friend |
Definition at line 213 of file SparseMatrixBase.h.
|
protected |
Definition at line 394 of file SparseMatrixBase.h.