Classes | Public Types | Public Member Functions | Protected Member Functions | Static Protected Member Functions | Protected Attributes | Private Member Functions | Friends | List of all members
Eigen::SparseMatrixBase Class Reference

Base class of any sparse matrices or sparse expressions. More...

#include <ForwardDeclarations.h>

Classes

struct  ConstSelfAdjointViewReturnType
 
struct  CwiseProductDenseReturnType
 
struct  SelfAdjointViewReturnType
 

Public Types

enum  {
  RowsAtCompileTime = internal::traits<Derived>::RowsAtCompileTime, ColsAtCompileTime = internal::traits<Derived>::ColsAtCompileTime, SizeAtCompileTime, MaxRowsAtCompileTime = RowsAtCompileTime,
  MaxColsAtCompileTime = ColsAtCompileTime, MaxSizeAtCompileTime, IsVectorAtCompileTime = RowsAtCompileTime == 1 || ColsAtCompileTime == 1, NumDimensions = int(MaxSizeAtCompileTime) == 1 ? 0 : bool(IsVectorAtCompileTime) ? 1 : 2,
  Flags = internal::traits<Derived>::Flags, IsRowMajor = Flags&RowMajorBit ? 1 : 0, InnerSizeAtCompileTime, _HasDirectAccess = (int(Flags)&DirectAccessBit) ? 1 : 0
}
 
typedef internal::conditional< NumTraits< Scalar >::IsComplex, CwiseUnaryOp< internal::scalar_conjugate_op< Scalar >, Eigen::Transpose< const Derived > >, Transpose< const Derived > >::type AdjointReturnType
 
typedef EigenBase< Derived > Base
 
typedef internal::conditional< _HasDirectAccess, const Scalar &, Scalar >::type CoeffReturnType
 
typedef CwiseNullaryOp< internal::scalar_constant_op< Scalar >, Matrix< Scalar, Dynamic, Dynamic > > ConstantReturnType
 
typedef internal::add_const< Transpose< const Derived > >::type ConstTransposeReturnType
 
typedef Matrix< Scalar, RowsAtCompileTime, ColsAtCompileTimeDenseMatrixType
 
typedef Matrix< StorageIndex, Dynamic, 1 > IndexVector
 
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 NumTraits< Scalar >::Real RealScalar
 
typedef internal::traits< Derived >::Scalar Scalar
 
typedef Matrix< Scalar, Dynamic, 1 > ScalarVector
 
typedef Matrix< Scalar, EIGEN_SIZE_MAX(RowsAtCompileTime, ColsAtCompileTime), EIGEN_SIZE_MAX(RowsAtCompileTime, ColsAtCompileTime)> SquareMatrixType
 
typedef SparseMatrixBase StorageBaseType
 
typedef internal::traits< Derived >::StorageIndex StorageIndex
 
typedef internal::traits< Derived >::StorageKind StorageKind
 
typedef Transpose< Derived > TransposeReturnType
 
typedef Scalar value_type
 

Public Member Functions

const AdjointReturnType adjoint () const
 
RealScalar blueNorm () const
 
Index cols () const
 
Derived & const_cast_derived () const
 
template<typename OtherDerived >
const EIGEN_STRONG_INLINE CwiseProductDenseReturnType< OtherDerived >::Type cwiseProduct (const MatrixBase< OtherDerived > &other) const
 
template<typename OtherDerived >
const EIGEN_STRONG_INLINE SparseMatrixBase< Derived >::template CwiseProductDenseReturnType< OtherDerived >::Type cwiseProduct (const MatrixBase< OtherDerived > &other) const
 
Derived & derived ()
 
const Derived & derived () const
 
template<typename OtherDerived >
internal::traits< Derived >::Scalar dot (const MatrixBase< OtherDerived > &other) const
 
template<typename OtherDerived >
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 SparseMatrixBase< OtherDerived > &other) const
 
const internal::eval< Derived >::type eval () const
 
Index innerSize () const
 
template<typename OtherDerived >
bool isApprox (const MatrixBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const
 
template<typename OtherDerived >
bool isApprox (const SparseMatrixBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const
 
bool isRValue () const
 
bool isVector () const
 
Derived & markAsRValue ()
 
RealScalar norm () const
 
template<typename OtherDerived >
const Product< Derived, OtherDerived > operator* (const DiagonalBase< OtherDerived > &other) const
 
template<typename OtherDerived >
const Product< Derived, OtherDerived > operator* (const MatrixBase< OtherDerived > &other) const
 
template<typename OtherDerived >
const Product< Derived, OtherDerived, AliasFreeProductoperator* (const SparseMatrixBase< OtherDerived > &other) const
 
template<typename Derived >
EIGEN_STRONG_INLINE Derived & operator*= (const Scalar &other)
 
Derived & operator*= (const Scalar &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 >
Derived & operator+= (const SparseMatrixBase< OtherDerived > &other)
 
template<typename OtherDerived >
EIGEN_STRONG_INLINE 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 >
Derived & operator-= (const SparseMatrixBase< OtherDerived > &other)
 
template<typename OtherDerived >
EIGEN_STRONG_INLINE Derived & operator-= (const SparseMatrixBase< OtherDerived > &other)
 
Derived & operator/= (const Scalar &other)
 
template<typename Derived >
Derived & operator= (const Derived &other)
 
Derived & operator= (const Derived &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)
 
Index outerSize () const
 
const SparseView< Derived > pruned (const Scalar &reference=Scalar(0), const RealScalar &epsilon=NumTraits< Scalar >::dummy_precision()) const
 
Index rows () const
 
template<unsigned int UpLo>
SparseMatrixBase< Derived >::template SelfAdjointViewReturnType< UpLo >::Type selfadjointView ()
 
template<unsigned int UpLo>
SelfAdjointViewReturnType< UpLo >::Type selfadjointView ()
 
template<unsigned int UpLo>
SparseMatrixBase< Derived >::template ConstSelfAdjointViewReturnType< UpLo >::Type selfadjointView () const
 
template<unsigned int UpLo>
ConstSelfAdjointViewReturnType< UpLo >::Type selfadjointView () const
 
Index size () const
 
 SparseMatrixBase ()
 
RealScalar squaredNorm () const
 
Scalar sum () const
 
DenseMatrixType toDense () const
 
TransposeReturnType transpose ()
 
const ConstTransposeReturnType transpose () const
 
template<int Mode>
const TriangularView< const Derived, Mode > triangularView () const
 
SparseSymmetricPermutationProduct< Derived, Upper|LowertwistedBy (const PermutationMatrix< Dynamic, Dynamic, StorageIndex > &perm) 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 friend Product< OtherDerived, Derived > operator* (const DiagonalBase< OtherDerived > &lhs, const SparseMatrixBase &rhs)
 
template<typename OtherDerived >
const friend Product< OtherDerived, Derived > operator* (const MatrixBase< OtherDerived > &lhs, const SparseMatrixBase &rhs)
 
std::ostream & operator<< (std::ostream &s, const SparseMatrixBase &m)
 

Detailed Description

Base class of any sparse matrices or sparse expressions.

Template Parameters
Derivedis 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 Extending MatrixBase (and other classes) by defining the preprocessor symbol EIGEN_SPARSEMATRIXBASE_PLUGIN.

Definition at line 301 of file ForwardDeclarations.h.

Member Typedef Documentation

◆ AdjointReturnType

Definition at line 114 of file SparseMatrixBase.h.

◆ Base

Definition at line 148 of file SparseMatrixBase.h.

◆ CoeffReturnType

Definition at line 132 of file SparseMatrixBase.h.

◆ ConstantReturnType

Definition at line 135 of file SparseMatrixBase.h.

◆ ConstTransposeReturnType

Definition at line 116 of file SparseMatrixBase.h.

◆ DenseMatrixType

type of the equivalent dense matrix

Definition at line 138 of file SparseMatrixBase.h.

◆ IndexVector

Definition at line 51 of file SparseMatrixBase.h.

◆ PacketReturnType

Definition at line 47 of file SparseMatrixBase.h.

◆ PacketScalar

Definition at line 38 of file SparseMatrixBase.h.

◆ PlainObject

Definition at line 119 of file SparseMatrixBase.h.

◆ 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.

See also
class NumTraits

Definition at line 128 of file SparseMatrixBase.h.

◆ Scalar

Definition at line 31 of file SparseMatrixBase.h.

◆ ScalarVector

Definition at line 52 of file SparseMatrixBase.h.

◆ SquareMatrixType

type of the equivalent square matrix

Definition at line 141 of file SparseMatrixBase.h.

◆ StorageBaseType

Definition at line 49 of file SparseMatrixBase.h.

◆ 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.

◆ StorageKind

Definition at line 39 of file SparseMatrixBase.h.

◆ TransposeReturnType

Definition at line 115 of file SparseMatrixBase.h.

◆ 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.

Member Enumeration Documentation

◆ anonymous enum

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.

See also
MatrixBase::rows(), MatrixBase::cols(), ColsAtCompileTime, SizeAtCompileTime
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.

See also
MatrixBase::rows(), MatrixBase::cols(), RowsAtCompileTime, SizeAtCompileTime
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.

See also
RowsAtCompileTime, ColsAtCompileTime
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).

NumDimensions 

This value is equal to Tensor::NumDimensions, i.e. 0 for scalars, 1 for vectors, and 2 for matrices.

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.

Constructor & Destructor Documentation

◆ SparseMatrixBase()

Eigen::SparseMatrixBase::SparseMatrixBase ( )
inline

Definition at line 197 of file SparseMatrixBase.h.

Member Function Documentation

◆ adjoint()

const AdjointReturnType Eigen::SparseMatrixBase::adjoint ( ) const
inline

Definition at line 356 of file SparseMatrixBase.h.

◆ assign()

template<typename OtherDerived >
Derived& Eigen::SparseMatrixBase::assign ( const OtherDerived &  other)
inlineprotected

◆ assignGeneric()

template<typename OtherDerived >
void Eigen::SparseMatrixBase::assignGeneric ( const OtherDerived &  other)
inlineprotected

◆ blueNorm()

NumTraits< typename internal::traits< Derived >::Scalar >::Real Eigen::SparseMatrixBase::blueNorm ( ) const
inline

Definition at line 92 of file SparseDot.h.

◆ cols()

Index Eigen::SparseMatrixBase::cols ( ) const
inline
Returns
the number of columns.
See also
rows()

Definition at line 178 of file SparseMatrixBase.h.

◆ const_cast_derived()

Derived& Eigen::SparseMatrixBase::const_cast_derived ( ) const
inline

Definition at line 145 of file SparseMatrixBase.h.

◆ convert_index()

static StorageIndex Eigen::SparseMatrixBase::convert_index ( const Index  idx)
inlinestaticprotected

Definition at line 389 of file SparseMatrixBase.h.

◆ cwiseProduct() [1/2]

template<typename OtherDerived >
const EIGEN_STRONG_INLINE CwiseProductDenseReturnType<OtherDerived>::Type Eigen::SparseMatrixBase::cwiseProduct ( const MatrixBase< OtherDerived > &  other) const

◆ cwiseProduct() [2/2]

template<typename OtherDerived >
const EIGEN_STRONG_INLINE SparseMatrixBase<Derived>::template CwiseProductDenseReturnType<OtherDerived>::Type Eigen::SparseMatrixBase::cwiseProduct ( const MatrixBase< OtherDerived > &  other) const

Definition at line 687 of file SparseCwiseBinaryOp.h.

◆ derived() [1/2]

Derived& Eigen::SparseMatrixBase::derived ( )
inline

Definition at line 144 of file SparseMatrixBase.h.

◆ derived() [2/2]

const Derived& Eigen::SparseMatrixBase::derived ( ) const
inline

Definition at line 143 of file SparseMatrixBase.h.

◆ dot() [1/4]

template<typename OtherDerived >
internal::traits<Derived>::Scalar Eigen::SparseMatrixBase::dot ( const MatrixBase< OtherDerived > &  other) const

Definition at line 18 of file SparseDot.h.

◆ dot() [2/4]

template<typename OtherDerived >
Scalar Eigen::SparseMatrixBase::dot ( const MatrixBase< OtherDerived > &  other) const

◆ dot() [3/4]

template<typename OtherDerived >
internal::traits<Derived>::Scalar Eigen::SparseMatrixBase::dot ( const SparseMatrixBase< OtherDerived > &  other) const

Definition at line 43 of file SparseDot.h.

◆ dot() [4/4]

template<typename OtherDerived >
Scalar Eigen::SparseMatrixBase::dot ( const SparseMatrixBase< OtherDerived > &  other) const

◆ eval()

const internal::eval<Derived>::type Eigen::SparseMatrixBase::eval ( ) const
inline
Returns
the matrix or vector obtained by evaluating this expression.

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 377 of file SparseMatrixBase.h.

◆ evalTo()

template<typename Dest >
void Eigen::SparseMatrixBase::evalTo ( Dest &  ) const
private

◆ innerSize()

Index Eigen::SparseMatrixBase::innerSize ( ) const
inline
Returns
the size of the inner dimension according to the storage order, i.e., the number of rows for a columns major matrix, and the number of cols otherwise

Definition at line 192 of file SparseMatrixBase.h.

◆ isApprox() [1/2]

template<typename OtherDerived >
bool Eigen::SparseMatrixBase::isApprox ( const MatrixBase< OtherDerived > &  other,
const RealScalar prec = NumTraits<Scalar>::dummy_precision() 
) const
inline

Definition at line 368 of file SparseMatrixBase.h.

◆ isApprox() [2/2]

template<typename OtherDerived >
bool Eigen::SparseMatrixBase::isApprox ( const SparseMatrixBase< OtherDerived > &  other,
const RealScalar prec = NumTraits<Scalar>::dummy_precision() 
) const

Definition at line 17 of file SparseFuzzy.h.

◆ isRValue()

bool Eigen::SparseMatrixBase::isRValue ( ) const
inline

Definition at line 194 of file SparseMatrixBase.h.

◆ isVector()

bool Eigen::SparseMatrixBase::isVector ( ) const
inline
Returns
true if either the number of rows or the number of columns is equal to 1. In other words, this function returns
rows()==1 || cols()==1
See also
rows(), cols(), IsVectorAtCompileTime.

Definition at line 186 of file SparseMatrixBase.h.

◆ markAsRValue()

Derived& Eigen::SparseMatrixBase::markAsRValue ( )
inline

Definition at line 195 of file SparseMatrixBase.h.

◆ norm()

NumTraits< typename internal::traits< Derived >::Scalar >::Real Eigen::SparseMatrixBase::norm ( ) const
inline

Definition at line 84 of file SparseDot.h.

◆ operator*() [1/3]

template<typename OtherDerived >
const Product<Derived,OtherDerived> Eigen::SparseMatrixBase::operator* ( const DiagonalBase< OtherDerived > &  other) const
inline

Definition at line 302 of file SparseMatrixBase.h.

◆ operator*() [2/3]

template<typename OtherDerived >
const Product<Derived,OtherDerived> Eigen::SparseMatrixBase::operator* ( const MatrixBase< OtherDerived > &  other) const
inline

Definition at line 319 of file SparseMatrixBase.h.

◆ operator*() [3/3]

template<typename OtherDerived >
const Product< Derived, OtherDerived, AliasFreeProduct > Eigen::SparseMatrixBase::operator* ( const SparseMatrixBase< OtherDerived > &  other) const
inline
Returns
an expression of the product of two sparse matrices. By default a conservative product preserving the symbolic non zeros is performed. The automatic pruning of the small values can be achieved by calling the pruned() function in which case a totally different product algorithm is employed:
C = (A*B).pruned(); // suppress numerical zeros (exact)
C = (A*B).pruned(ref);
where ref is a meaningful non zero reference value.

Definition at line 29 of file SparseProduct.h.

◆ operator*=() [1/3]

template<typename Derived >
EIGEN_STRONG_INLINE Derived& Eigen::SparseMatrixBase::operator*= ( const Scalar other)

Definition at line 126 of file SparseCwiseUnaryOp.h.

◆ operator*=() [2/3]

Derived& Eigen::SparseMatrixBase::operator*= ( const Scalar other)

◆ operator*=() [3/3]

template<typename OtherDerived >
Derived& Eigen::SparseMatrixBase::operator*= ( const SparseMatrixBase< OtherDerived > &  other)

◆ operator+=() [1/4]

template<typename OtherDerived >
Derived & Eigen::SparseMatrixBase::operator+= ( const DiagonalBase< OtherDerived > &  other)

Definition at line 670 of file SparseCwiseBinaryOp.h.

◆ operator+=() [2/4]

template<typename OtherDerived >
Derived & Eigen::SparseMatrixBase::operator+= ( const EigenBase< OtherDerived > &  other)

Definition at line 638 of file SparseCwiseBinaryOp.h.

◆ operator+=() [3/4]

template<typename OtherDerived >
Derived& Eigen::SparseMatrixBase::operator+= ( const SparseMatrixBase< OtherDerived > &  other)

◆ operator+=() [4/4]

template<typename OtherDerived >
EIGEN_STRONG_INLINE Derived& Eigen::SparseMatrixBase::operator+= ( const SparseMatrixBase< OtherDerived > &  other)

Definition at line 663 of file SparseCwiseBinaryOp.h.

◆ operator-=() [1/4]

template<typename OtherDerived >
Derived & Eigen::SparseMatrixBase::operator-= ( const DiagonalBase< OtherDerived > &  other)

Definition at line 678 of file SparseCwiseBinaryOp.h.

◆ operator-=() [2/4]

template<typename OtherDerived >
Derived & Eigen::SparseMatrixBase::operator-= ( const EigenBase< OtherDerived > &  other)

Definition at line 646 of file SparseCwiseBinaryOp.h.

◆ operator-=() [3/4]

template<typename OtherDerived >
Derived& Eigen::SparseMatrixBase::operator-= ( const SparseMatrixBase< OtherDerived > &  other)

◆ operator-=() [4/4]

template<typename OtherDerived >
EIGEN_STRONG_INLINE Derived& Eigen::SparseMatrixBase::operator-= ( const SparseMatrixBase< OtherDerived > &  other)

Definition at line 655 of file SparseCwiseBinaryOp.h.

◆ operator/=()

EIGEN_STRONG_INLINE Derived & Eigen::SparseMatrixBase::operator/= ( const Scalar other)

Definition at line 138 of file SparseCwiseUnaryOp.h.

◆ operator=() [1/5]

template<typename Derived >
Derived& Eigen::SparseMatrixBase::operator= ( const Derived &  other)
inline

Definition at line 43 of file SparseAssign.h.

◆ operator=() [2/5]

Derived& Eigen::SparseMatrixBase::operator= ( const Derived &  other)
inline

◆ operator=() [3/5]

template<typename OtherDerived >
Derived & Eigen::SparseMatrixBase::operator= ( const EigenBase< OtherDerived > &  other)

Definition at line 17 of file SparseAssign.h.

◆ operator=() [4/5]

template<typename OtherDerived >
Derived & Eigen::SparseMatrixBase::operator= ( const ReturnByValue< OtherDerived > &  other)

Definition at line 25 of file SparseAssign.h.

◆ operator=() [5/5]

template<typename OtherDerived >
Derived & Eigen::SparseMatrixBase::operator= ( const SparseMatrixBase< OtherDerived > &  other)
inline

Definition at line 34 of file SparseAssign.h.

◆ outerSize()

Index Eigen::SparseMatrixBase::outerSize ( ) const
inline
Returns
the size of the storage major dimension, i.e., the number of columns for a columns major matrix, and the number of rows otherwise

Definition at line 189 of file SparseMatrixBase.h.

◆ pruned()

const SparseView< Derived > Eigen::SparseMatrixBase::pruned ( const Scalar reference = Scalar(0),
const RealScalar epsilon = NumTraits<Scalar>::dummy_precision() 
) const
inline
Returns
an expression of *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:

C = (A*B).pruned(); // suppress numerical zeros (exact)
C = (A*B).pruned(ref);

where ref is a meaningful non zero reference value.

Definition at line 246 of file SparseView.h.

◆ rows()

Index Eigen::SparseMatrixBase::rows ( ) const
inline
Returns
the number of rows.
See also
cols()

Definition at line 176 of file SparseMatrixBase.h.

◆ selfadjointView() [1/4]

template<unsigned int UpLo>
SparseMatrixBase<Derived>::template SelfAdjointViewReturnType<UpLo>::Type Eigen::SparseMatrixBase::selfadjointView ( )

Definition at line 185 of file SparseSelfAdjointView.h.

◆ selfadjointView() [2/4]

template<unsigned int UpLo>
SelfAdjointViewReturnType<UpLo>::Type Eigen::SparseMatrixBase::selfadjointView ( )
inline

◆ selfadjointView() [3/4]

template<unsigned int UpLo>
SparseMatrixBase<Derived>::template ConstSelfAdjointViewReturnType<UpLo>::Type Eigen::SparseMatrixBase::selfadjointView ( ) const

Definition at line 178 of file SparseSelfAdjointView.h.

◆ selfadjointView() [4/4]

template<unsigned int UpLo>
ConstSelfAdjointViewReturnType<UpLo>::Type Eigen::SparseMatrixBase::selfadjointView ( ) const
inline

◆ size()

Index Eigen::SparseMatrixBase::size ( ) const
inline
Returns
the number of coefficients, which is rows()*cols().
See also
rows(), cols().

Definition at line 181 of file SparseMatrixBase.h.

◆ squaredNorm()

NumTraits< typename internal::traits< Derived >::Scalar >::Real Eigen::SparseMatrixBase::squaredNorm ( ) const
inline

Definition at line 77 of file SparseDot.h.

◆ sum()

internal::traits< Derived >::Scalar Eigen::SparseMatrixBase::sum ( ) const

Definition at line 17 of file SparseRedux.h.

◆ toDense()

DenseMatrixType Eigen::SparseMatrixBase::toDense ( ) const
inline

Definition at line 358 of file SparseMatrixBase.h.

◆ transpose() [1/2]

TransposeReturnType Eigen::SparseMatrixBase::transpose ( )
inline

Definition at line 354 of file SparseMatrixBase.h.

◆ transpose() [2/2]

const ConstTransposeReturnType Eigen::SparseMatrixBase::transpose ( ) const
inline

Definition at line 355 of file SparseMatrixBase.h.

◆ triangularView()

template<int Mode>
const TriangularView< const Derived, Mode > Eigen::SparseMatrixBase::triangularView ( ) const
inline

Definition at line 182 of file SparseTriangularView.h.

◆ twistedBy()

SparseSymmetricPermutationProduct<Derived,Upper|Lower> Eigen::SparseMatrixBase::twistedBy ( const PermutationMatrix< Dynamic, Dynamic, StorageIndex > &  perm) const
inline
Returns
an expression of P H P^-1 where H is the matrix represented by *this

Definition at line 329 of file SparseMatrixBase.h.

Friends And Related Function Documentation

◆ operator* [1/2]

template<typename OtherDerived >
const friend Product<OtherDerived,Derived> operator* ( const DiagonalBase< OtherDerived > &  lhs,
const SparseMatrixBase rhs 
)
friend

Definition at line 308 of file SparseMatrixBase.h.

◆ operator* [2/2]

template<typename OtherDerived >
const friend Product<OtherDerived,Derived> operator* ( const MatrixBase< OtherDerived > &  lhs,
const SparseMatrixBase rhs 
)
friend

Definition at line 325 of file SparseMatrixBase.h.

◆ operator<<

std::ostream& operator<< ( std::ostream &  s,
const SparseMatrixBase m 
)
friend

Definition at line 218 of file SparseMatrixBase.h.

Member Data Documentation

◆ m_isRValue

bool Eigen::SparseMatrixBase::m_isRValue
protected

Definition at line 387 of file SparseMatrixBase.h.


The documentation for this class was generated from the following files:
Eigen::SparseMatrixBase::rows
Index rows() const
Definition: SparseMatrixBase.h:176
B
Definition: test_numpy_dtypes.cpp:299
epsilon
static double epsilon
Definition: testRot3.cpp:37
A
Definition: test_numpy_dtypes.cpp:298
Eigen::SparseMatrixBase::cols
Index cols() const
Definition: SparseMatrixBase.h:178
C
Matrix< Scalar, Dynamic, Dynamic > C
Definition: bench_gemm.cpp:50
ref
Reference counting helper.
Definition: object.h:67
Eigen::SparseMatrixBase::pruned
const SparseView< Derived > pruned(const Scalar &reference=Scalar(0), const RealScalar &epsilon=NumTraits< Scalar >::dummy_precision()) const
Definition: SparseView.h:246


gtsam
Author(s):
autogenerated on Thu Jun 13 2024 03:13:54