Classes | Public Types | Public Member Functions | Protected Types | Protected Attributes | List of all members
Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index > Class Template Reference

A sparse matrix class designed for matrix assembly purpose. More...

#include <SparseUtil.h>

Inheritance diagram for Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >:
Inheritance graph
[legend]

Classes

class  InnerIterator
 
class  ReverseInnerIterator
 

Public Types

enum  { Options = _Options }
 
typedef MappedSparseMatrix< Scalar, FlagsMap
 
- Public Types inherited from Eigen::SparseMatrixBase< DynamicSparseMatrix< _Scalar, _Options, _Index > >
enum  
 
typedef internal::conditional< NumTraits< Scalar >::IsComplex, CwiseUnaryOp< internal::scalar_conjugate_op< Scalar >, Eigen::Transpose< const DynamicSparseMatrix< _Scalar, _Options, _Index > > >, Transpose< const DynamicSparseMatrix< _Scalar, _Options, _Index > > >::type AdjointReturnType
 
typedef EigenBase< DynamicSparseMatrix< _Scalar, _Options, _Index > > Base
 
typedef internal::conditional< _HasDirectAccess, const Scalar &, Scalar >::type CoeffReturnType
 
typedef Block< DynamicSparseMatrix< _Scalar, _Options, _Index >, internal::traits< DynamicSparseMatrix< _Scalar, _Options, _Index > >::RowsAtCompileTime, Dynamic,!IsRowMajorColsBlockXpr
 
typedef Block< DynamicSparseMatrix< _Scalar, _Options, _Index >, internal::traits< DynamicSparseMatrix< _Scalar, _Options, _Index > >::RowsAtCompileTime, 1,!IsRowMajorColXpr
 
typedef internal::conditional< NumTraits< Scalar >::IsComplex, const CwiseUnaryOp< internal::scalar_conjugate_op< Scalar >, const DynamicSparseMatrix< _Scalar, _Options, _Index > >, const DynamicSparseMatrix< _Scalar, _Options, _Index > & >::type ConjugateReturnType
 
typedef CwiseNullaryOp< internal::scalar_constant_op< Scalar >, Matrix< Scalar, Dynamic, Dynamic > > ConstantReturnType
 
typedef const Block< const DynamicSparseMatrix< _Scalar, _Options, _Index >, internal::traits< DynamicSparseMatrix< _Scalar, _Options, _Index > >::RowsAtCompileTime, Dynamic,!IsRowMajorConstColsBlockXpr
 
typedef const Block< const DynamicSparseMatrix< _Scalar, _Options, _Index >, internal::traits< DynamicSparseMatrix< _Scalar, _Options, _Index > >::RowsAtCompileTime, 1,!IsRowMajorConstColXpr
 
typedef Block< const DynamicSparseMatrix< _Scalar, _Options, _Index >, IsRowMajor?1:Dynamic, IsRowMajor?Dynamic:1, true > ConstInnerVectorReturnType
 
typedef const Block< const DynamicSparseMatrix< _Scalar, _Options, _Index >, Dynamic, internal::traits< DynamicSparseMatrix< _Scalar, _Options, _Index > >::ColsAtCompileTime, IsRowMajorConstRowsBlockXpr
 
typedef const Block< const DynamicSparseMatrix< _Scalar, _Options, _Index >, 1, internal::traits< DynamicSparseMatrix< _Scalar, _Options, _Index > >::ColsAtCompileTime, IsRowMajorConstRowXpr
 
typedef const VectorBlock< const DynamicSparseMatrix< _Scalar, _Options, _Index > > ConstSegmentReturnType
 
typedef CwiseUnaryOp< internal::scalar_imag_op< Scalar >, const DynamicSparseMatrix< _Scalar, _Options, _Index > > ImagReturnType
 
typedef internal::traits< DynamicSparseMatrix< _Scalar, _Options, _Index > >::Index Index
 
typedef Block< DynamicSparseMatrix< _Scalar, _Options, _Index >, IsRowMajor?1:Dynamic, IsRowMajor?Dynamic:1, true > InnerVectorReturnType
 
typedef CwiseUnaryView< internal::scalar_imag_ref_op< Scalar >, DynamicSparseMatrix< _Scalar, _Options, _Index > > NonConstImagReturnType
 
typedef internal::conditional< NumTraits< Scalar >::IsComplex, CwiseUnaryView< internal::scalar_real_ref_op< Scalar >, DynamicSparseMatrix< _Scalar, _Options, _Index > >, DynamicSparseMatrix< _Scalar, _Options, _Index > & >::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, IndexPlainObject
 
typedef internal::conditional< NumTraits< Scalar >::IsComplex, const CwiseUnaryOp< internal::scalar_real_op< Scalar >, const DynamicSparseMatrix< _Scalar, _Options, _Index > >, const DynamicSparseMatrix< _Scalar, _Options, _Index > & >::type RealReturnType
 
typedef NumTraits< Scalar >::Real RealScalar
 
typedef Block< DynamicSparseMatrix< _Scalar, _Options, _Index >, Dynamic, internal::traits< DynamicSparseMatrix< _Scalar, _Options, _Index > >::ColsAtCompileTime, IsRowMajorRowsBlockXpr
 
typedef Block< DynamicSparseMatrix< _Scalar, _Options, _Index >, 1, internal::traits< DynamicSparseMatrix< _Scalar, _Options, _Index > >::ColsAtCompileTime, IsRowMajorRowXpr
 
typedef internal::traits< DynamicSparseMatrix< _Scalar, _Options, _Index > >::Scalar Scalar
 
typedef CwiseUnaryOp< internal::scalar_multiple_op< Scalar >, const DynamicSparseMatrix< _Scalar, _Options, _Index > > ScalarMultipleReturnType
 
typedef CwiseUnaryOp< internal::scalar_quotient1_op< Scalar >, const DynamicSparseMatrix< _Scalar, _Options, _Index > > ScalarQuotient1ReturnType
 
typedef VectorBlock< DynamicSparseMatrix< _Scalar, _Options, _Index > > SegmentReturnType
 
typedef Matrix< Scalar, EIGEN_SIZE_MAX(RowsAtCompileTime, ColsAtCompileTime), EIGEN_SIZE_MAX(RowsAtCompileTime, ColsAtCompileTime)> SquareMatrixType
 
typedef SparseMatrixBase StorageBaseType
 
typedef internal::traits< DynamicSparseMatrix< _Scalar, _Options, _Index > >::StorageKind StorageKind
 
- Public Types inherited from Eigen::EigenBase< Derived >
typedef internal::traits< Derived >::Index Index
 
typedef internal::traits< Derived >::StorageKind StorageKind
 

Public Member Functions

std::vector< internal::CompressedStorage< Scalar, Index > > & _data ()
 
const std::vector< internal::CompressedStorage< Scalar, Index > > & _data () const
 
Scalar coeff (Index row, Index col) const
 
ScalarcoeffRef (Index row, Index col)
 
Index cols () const
 
EIGEN_DEPRECATED DynamicSparseMatrix ()
 
EIGEN_DEPRECATED DynamicSparseMatrix (Index rows, Index cols)
 
template<typename OtherDerived >
EIGEN_DEPRECATED DynamicSparseMatrix (const SparseMatrixBase< OtherDerived > &other)
 
 DynamicSparseMatrix (const DynamicSparseMatrix &other)
 
EIGEN_DEPRECATED void endFill ()
 
EIGEN_DEPRECATED Scalarfill (Index row, Index col)
 
EIGEN_DEPRECATED Scalarfillrand (Index row, Index col)
 
void finalize ()
 
Index innerNonZeros (Index j) const
 
Index innerSize () const
 
Scalarinsert (Index row, Index col)
 
ScalarinsertBack (Index row, Index col)
 
ScalarinsertBackByOuterInner (Index outer, Index inner)
 
Index nonZeros () const
 
DynamicSparseMatrixoperator= (const DynamicSparseMatrix &other)
 
Index outerSize () const
 
void prune (Scalar reference, RealScalar epsilon=NumTraits< RealScalar >::dummy_precision())
 
void reserve (Index reserveSize=1000)
 
void resize (Index rows, Index cols)
 
void resizeAndKeepData (Index rows, Index cols)
 
Index rows () const
 
void setZero ()
 
EIGEN_DEPRECATED void startFill (Index reserveSize=1000)
 
void startVec (Index)
 
void swap (DynamicSparseMatrix &other)
 
 ~DynamicSparseMatrix ()
 
- Public Member Functions inherited from Eigen::SparseMatrixBase< DynamicSparseMatrix< _Scalar, _Options, _Index > >
const AdjointReturnType adjoint () const
 
EIGEN_STRONG_INLINE const CwiseBinaryOp< CustomBinaryOp, const DynamicSparseMatrix< _Scalar, _Options, _Index >, const OtherDerived > binaryExpr (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other, const CustomBinaryOp &func=CustomBinaryOp()) const
 
Block< DynamicSparseMatrix< _Scalar, _Options, _Index > > block (Index startRow, Index startCol, Index blockRows, Index blockCols)
 
const Block< const DynamicSparseMatrix< _Scalar, _Options, _Index > > block (Index startRow, Index startCol, Index blockRows, Index blockCols) const
 
Block< DynamicSparseMatrix< _Scalar, _Options, _Index >, BlockRows, BlockCols > block (Index startRow, Index startCol)
 
const Block< const DynamicSparseMatrix< _Scalar, _Options, _Index >, BlockRows, BlockCols > block (Index startRow, Index startCol) const
 
Block< DynamicSparseMatrix< _Scalar, _Options, _Index >, BlockRows, BlockCols > block (Index startRow, Index startCol, Index blockRows, Index blockCols)
 
const Block< const DynamicSparseMatrix< _Scalar, _Options, _Index >, BlockRows, BlockCols > block (Index startRow, Index startCol, Index blockRows, Index blockCols) const
 
RealScalar blueNorm () const
 
Block< DynamicSparseMatrix< _Scalar, _Options, _Index > > bottomLeftCorner (Index cRows, Index cCols)
 
const Block< const DynamicSparseMatrix< _Scalar, _Options, _Index > > bottomLeftCorner (Index cRows, Index cCols) const
 
Block< DynamicSparseMatrix< _Scalar, _Options, _Index >, CRows, CCols > bottomLeftCorner ()
 
const Block< const DynamicSparseMatrix< _Scalar, _Options, _Index >, CRows, CCols > bottomLeftCorner () const
 
Block< DynamicSparseMatrix< _Scalar, _Options, _Index >, CRows, CCols > bottomLeftCorner (Index cRows, Index cCols)
 
const Block< const DynamicSparseMatrix< _Scalar, _Options, _Index >, CRows, CCols > bottomLeftCorner (Index cRows, Index cCols) const
 
Block< DynamicSparseMatrix< _Scalar, _Options, _Index > > bottomRightCorner (Index cRows, Index cCols)
 
const Block< const DynamicSparseMatrix< _Scalar, _Options, _Index > > bottomRightCorner (Index cRows, Index cCols) const
 
Block< DynamicSparseMatrix< _Scalar, _Options, _Index >, CRows, CCols > bottomRightCorner ()
 
const Block< const DynamicSparseMatrix< _Scalar, _Options, _Index >, CRows, CCols > bottomRightCorner () const
 
Block< DynamicSparseMatrix< _Scalar, _Options, _Index >, CRows, CCols > bottomRightCorner (Index cRows, Index cCols)
 
const Block< const DynamicSparseMatrix< _Scalar, _Options, _Index >, CRows, CCols > bottomRightCorner (Index cRows, Index cCols) const
 
RowsBlockXpr bottomRows (Index n)
 
ConstRowsBlockXpr bottomRows (Index n) const
 
NRowsBlockXpr< N >::Type bottomRows ()
 
ConstNRowsBlockXpr< N >::Type bottomRows () const
 
internal::cast_return_type< DynamicSparseMatrix< _Scalar, _Options, _Index >, const CwiseUnaryOp< internal::scalar_cast_op< typename internal::traits< DynamicSparseMatrix< _Scalar, _Options, _Index > >::Scalar, NewType >, const DynamicSparseMatrix< _Scalar, _Options, _Index > > >::type cast () const
 
ColXpr col (Index i)
 
ConstColXpr col (Index i) const
 
Index cols () const
 
ConjugateReturnType conjugate () const
 
DynamicSparseMatrix< _Scalar, _Options, _Index > & const_cast_derived () const
 
EIGEN_STRONG_INLINE const CwiseUnaryOp< internal::scalar_abs_op< Scalar >, const DynamicSparseMatrix< _Scalar, _Options, _Index > > cwiseAbs () const
 
EIGEN_STRONG_INLINE const CwiseUnaryOp< internal::scalar_abs2_op< Scalar >, const DynamicSparseMatrix< _Scalar, _Options, _Index > > cwiseAbs2 () const
 
const CwiseBinaryOp< std::equal_to< Scalar >, const DynamicSparseMatrix< _Scalar, _Options, _Index >, const OtherDerived > cwiseEqual (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
const CwiseUnaryOp< std::binder1st< std::equal_to< Scalar > >, const DynamicSparseMatrix< _Scalar, _Options, _Index > > cwiseEqual (const Scalar &s) const
 
const CwiseUnaryOp< internal::scalar_inverse_op< Scalar >, const DynamicSparseMatrix< _Scalar, _Options, _Index > > cwiseInverse () const
 
EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_max_op< Scalar >, const DynamicSparseMatrix< _Scalar, _Options, _Index >, const OtherDerived > cwiseMax (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_max_op< Scalar >, const DynamicSparseMatrix< _Scalar, _Options, _Index >, const ConstantReturnTypecwiseMax (const Scalar &other) const
 
EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_min_op< Scalar >, const DynamicSparseMatrix< _Scalar, _Options, _Index >, const OtherDerived > cwiseMin (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_min_op< Scalar >, const DynamicSparseMatrix< _Scalar, _Options, _Index >, const ConstantReturnTypecwiseMin (const Scalar &other) const
 
const CwiseBinaryOp< std::not_equal_to< Scalar >, const DynamicSparseMatrix< _Scalar, _Options, _Index >, const OtherDerived > cwiseNotEqual (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
EIGEN_STRONG_INLINE const EIGEN_SPARSE_CWISE_PRODUCT_RETURN_TYPE cwiseProduct (const MatrixBase< OtherDerived > &other) const
 
EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_quotient_op< Scalar >, const DynamicSparseMatrix< _Scalar, _Options, _Index >, const OtherDerived > cwiseQuotient (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
const CwiseUnaryOp< internal::scalar_sqrt_op< Scalar >, const DynamicSparseMatrix< _Scalar, _Options, _Index > > cwiseSqrt () const
 
const DynamicSparseMatrix< _Scalar, _Options, _Index > & derived () const
 
DynamicSparseMatrix< _Scalar, _Options, _Index > & derived ()
 
Scalar dot (const MatrixBase< OtherDerived > &other) const
 
Scalar dot (const SparseMatrixBase< OtherDerived > &other) const
 
EIGEN_STRONG_INLINE const EIGEN_CWISE_PRODUCT_RETURN_TYPE (DynamicSparseMatrix< _Scalar, _Options, _Index >, OtherDerived) cwiseProduct(const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
const internal::eval< DynamicSparseMatrix< _Scalar, _Options, _Index > >::type eval () const
 
void evalTo (MatrixBase< DenseDerived > &dst) const
 
SegmentReturnType head (Index vecSize)
 
ConstSegmentReturnType head (Index vecSize) const
 
FixedSegmentReturnType< Size >::Type head ()
 
ConstFixedSegmentReturnType< Size >::Type head () const
 
const ImagReturnType imag () const
 
NonConstImagReturnType imag ()
 
Index innerSize () const
 
InnerVectorReturnType innerVector (Index outer)
 
const ConstInnerVectorReturnType innerVector (Index outer) const
 
Block< DynamicSparseMatrix< _Scalar, _Options, _Index >, Dynamic, Dynamic, true > innerVectors (Index outerStart, Index outerSize)
 
const Block< const DynamicSparseMatrix< _Scalar, _Options, _Index >, Dynamic, Dynamic, true > 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
 
ColsBlockXpr leftCols (Index n)
 
ConstColsBlockXpr leftCols (Index n) const
 
NColsBlockXpr< N >::Type leftCols ()
 
ConstNColsBlockXpr< N >::Type leftCols () const
 
DynamicSparseMatrix< _Scalar, _Options, _Index > & markAsRValue ()
 
ColsBlockXpr middleCols (Index startCol, Index numCols)
 
ConstColsBlockXpr middleCols (Index startCol, Index numCols) const
 
NColsBlockXpr< N >::Type middleCols (Index startCol)
 
ConstNColsBlockXpr< N >::Type middleCols (Index startCol) const
 
RowsBlockXpr middleRows (Index startRow, Index numRows)
 
ConstRowsBlockXpr middleRows (Index startRow, Index numRows) const
 
NRowsBlockXpr< N >::Type middleRows (Index startRow)
 
ConstNRowsBlockXpr< N >::Type middleRows (Index startRow) const
 
Index nonZeros () const
 
RealScalar norm () const
 
const ScalarMultipleReturnType operator* (const Scalar &scalar) const
 
const CwiseUnaryOp< internal::scalar_multiple2_op< Scalar, std::complex< Scalar > >, const DynamicSparseMatrix< _Scalar, _Options, _Index > > operator* (const std::complex< Scalar > &scalar) const
 
const SparseSparseProductReturnType< DynamicSparseMatrix< _Scalar, _Options, _Index >, OtherDerived >::Type operator* (const SparseMatrixBase< OtherDerived > &other) const
 
const SparseDiagonalProduct< DynamicSparseMatrix< _Scalar, _Options, _Index >, OtherDerived > operator* (const DiagonalBase< OtherDerived > &other) const
 
const SparseDenseProductReturnType< DynamicSparseMatrix< _Scalar, _Options, _Index >, OtherDerived >::Type operator* (const MatrixBase< OtherDerived > &other) const
 
DynamicSparseMatrix< _Scalar, _Options, _Index > & operator*= (const Scalar &other)
 
DynamicSparseMatrix< _Scalar, _Options, _Index > & operator*= (const SparseMatrixBase< OtherDerived > &other)
 
DynamicSparseMatrix< _Scalar, _Options, _Index > & operator+= (const SparseMatrixBase< OtherDerived > &other)
 
const CwiseUnaryOp< internal::scalar_opposite_op< typename internal::traits< DynamicSparseMatrix< _Scalar, _Options, _Index > >::Scalar >, const DynamicSparseMatrix< _Scalar, _Options, _Index > > operator- () const
 
DynamicSparseMatrix< _Scalar, _Options, _Index > & operator-= (const SparseMatrixBase< OtherDerived > &other)
 
const CwiseUnaryOp< internal::scalar_quotient1_op< typename internal::traits< DynamicSparseMatrix< _Scalar, _Options, _Index > >::Scalar >, const DynamicSparseMatrix< _Scalar, _Options, _Index > > operator/ (const Scalar &scalar) const
 
DynamicSparseMatrix< _Scalar, _Options, _Index > & operator/= (const Scalar &other)
 
DynamicSparseMatrix< _Scalar, _Options, _Index > & operator= (const EigenBase< OtherDerived > &other)
 
DynamicSparseMatrix< _Scalar, _Options, _Index > & operator= (const ReturnByValue< OtherDerived > &other)
 
DynamicSparseMatrix< _Scalar, _Options, _Index > & operator= (const SparseMatrixBase< OtherDerived > &other)
 
DynamicSparseMatrix< _Scalar, _Options, _Index > & operator= (const DynamicSparseMatrix< _Scalar, _Options, _Index > &other)
 
DynamicSparseMatrix< _Scalar, _Options, _Index > & operator= (const SparseSparseProduct< Lhs, Rhs > &product)
 
Index outerSize () const
 
RealReturnType real () const
 
NonConstRealReturnType real ()
 
ColsBlockXpr rightCols (Index n)
 
ConstColsBlockXpr rightCols (Index n) const
 
NColsBlockXpr< N >::Type rightCols ()
 
ConstNColsBlockXpr< N >::Type rightCols () const
 
RowXpr row (Index i)
 
ConstRowXpr row (Index i) const
 
Index rows () const
 
SegmentReturnType segment (Index start, Index vecSize)
 
ConstSegmentReturnType segment (Index start, Index vecSize) const
 
FixedSegmentReturnType< Size >::Type segment (Index start)
 
ConstFixedSegmentReturnType< Size >::Type segment (Index start) const
 
const SparseSelfAdjointView< DynamicSparseMatrix< _Scalar, _Options, _Index >, UpLo > selfadjointView () const
 
SparseSelfAdjointView< DynamicSparseMatrix< _Scalar, _Options, _Index >, UpLo > selfadjointView ()
 
Index size () const
 
 SparseMatrixBase ()
 
RealScalar squaredNorm () const
 
Scalar sum () const
 
SegmentReturnType tail (Index vecSize)
 
ConstSegmentReturnType tail (Index vecSize) const
 
FixedSegmentReturnType< Size >::Type tail ()
 
ConstFixedSegmentReturnType< Size >::Type tail () const
 
Matrix< Scalar, RowsAtCompileTime, ColsAtCompileTimetoDense () const
 
Block< DynamicSparseMatrix< _Scalar, _Options, _Index > > topLeftCorner (Index cRows, Index cCols)
 
const Block< const DynamicSparseMatrix< _Scalar, _Options, _Index > > topLeftCorner (Index cRows, Index cCols) const
 
Block< DynamicSparseMatrix< _Scalar, _Options, _Index >, CRows, CCols > topLeftCorner ()
 
const Block< const DynamicSparseMatrix< _Scalar, _Options, _Index >, CRows, CCols > topLeftCorner () const
 
Block< DynamicSparseMatrix< _Scalar, _Options, _Index >, CRows, CCols > topLeftCorner (Index cRows, Index cCols)
 
const Block< const DynamicSparseMatrix< _Scalar, _Options, _Index >, CRows, CCols > topLeftCorner (Index cRows, Index cCols) const
 
Block< DynamicSparseMatrix< _Scalar, _Options, _Index > > topRightCorner (Index cRows, Index cCols)
 
const Block< const DynamicSparseMatrix< _Scalar, _Options, _Index > > topRightCorner (Index cRows, Index cCols) const
 
Block< DynamicSparseMatrix< _Scalar, _Options, _Index >, CRows, CCols > topRightCorner ()
 
const Block< const DynamicSparseMatrix< _Scalar, _Options, _Index >, CRows, CCols > topRightCorner () const
 
Block< DynamicSparseMatrix< _Scalar, _Options, _Index >, CRows, CCols > topRightCorner (Index cRows, Index cCols)
 
const Block< const DynamicSparseMatrix< _Scalar, _Options, _Index >, CRows, CCols > topRightCorner (Index cRows, Index cCols) const
 
RowsBlockXpr topRows (Index n)
 
ConstRowsBlockXpr topRows (Index n) const
 
NRowsBlockXpr< N >::Type topRows ()
 
ConstNRowsBlockXpr< N >::Type topRows () const
 
Transpose< DynamicSparseMatrix< _Scalar, _Options, _Index > > transpose ()
 
const Transpose< const DynamicSparseMatrix< _Scalar, _Options, _Index > > transpose () const
 
const SparseTriangularView< DynamicSparseMatrix< _Scalar, _Options, _Index >, Mode > triangularView () const
 
SparseSymmetricPermutationProduct< DynamicSparseMatrix< _Scalar, _Options, _Index >, Upper|Lower > twistedBy (const PermutationMatrix< Dynamic, Dynamic, Index > &perm) const
 
const CwiseUnaryOp< CustomUnaryOp, const DynamicSparseMatrix< _Scalar, _Options, _Index > > unaryExpr (const CustomUnaryOp &func=CustomUnaryOp()) const
 Apply a unary operator coefficient-wise. More...
 
const CwiseUnaryView< CustomViewOp, const DynamicSparseMatrix< _Scalar, _Options, _Index > > unaryViewExpr (const CustomViewOp &func=CustomViewOp()) const
 
- Public Member Functions inherited from Eigen::EigenBase< Derived >
template<typename Dest >
void addTo (Dest &dst) const
 
template<typename Dest >
void applyThisOnTheLeft (Dest &dst) const
 
template<typename Dest >
void applyThisOnTheRight (Dest &dst) const
 
Index cols () const
 
Derived & const_cast_derived () const
 
const Derived & const_derived () const
 
Derived & derived ()
 
const Derived & derived () const
 
template<typename Dest >
void evalTo (Dest &dst) const
 
Index rows () const
 
Index size () const
 
template<typename Dest >
void subTo (Dest &dst) const
 

Protected Types

typedef DynamicSparseMatrix< Scalar,(Flags &~RowMajorBit)|(IsRowMajor?RowMajorBit:0)> TransposedSparseMatrix
 

Protected Attributes

std::vector< internal::CompressedStorage< Scalar, Index > > m_data
 
Index m_innerSize
 
- Protected Attributes inherited from Eigen::SparseMatrixBase< DynamicSparseMatrix< _Scalar, _Options, _Index > >
bool m_isRValue
 

Additional Inherited Members

- Protected Member Functions inherited from Eigen::SparseMatrixBase< DynamicSparseMatrix< _Scalar, _Options, _Index > >
DynamicSparseMatrix< _Scalar, _Options, _Index > & assign (const OtherDerived &other)
 
void assignGeneric (const OtherDerived &other)
 

Detailed Description

template<typename _Scalar, int _Options, typename _Index>
class Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >

A sparse matrix class designed for matrix assembly purpose.

Deprecated:
use a SparseMatrix in an uncompressed mode
Parameters
_Scalarthe scalar type, i.e. the type of the coefficients

Unlike SparseMatrix, this class provides a much higher degree of flexibility. In particular, it allows random read/write accesses in log(rho*outer_size) where rho is the probability that a coefficient is nonzero and outer_size is the number of columns if the matrix is column-major and the number of rows otherwise.

Internally, the data are stored as a std::vector of compressed vector. The performances of random writes might decrease as the number of nonzeros per inner-vector increase. In practice, we observed very good performance till about 100 nonzeros/vector, and the performance remains relatively good till 500 nonzeros/vectors.

See also
SparseMatrix

Definition at line 72 of file SparseUtil.h.

Member Typedef Documentation

template<typename _Scalar, int _Options, typename _Index>
typedef MappedSparseMatrix<Scalar,Flags> Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::Map

Definition at line 64 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
typedef DynamicSparseMatrix<Scalar,(Flags&~RowMajorBit)|(IsRowMajor?RowMajorBit:0)> Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::TransposedSparseMatrix
protected

Definition at line 73 of file DynamicSparseMatrix.h.

Member Enumeration Documentation

template<typename _Scalar, int _Options, typename _Index>
anonymous enum
Enumerator
Options 

Definition at line 67 of file DynamicSparseMatrix.h.

Constructor & Destructor Documentation

template<typename _Scalar, int _Options, typename _Index>
EIGEN_DEPRECATED Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::DynamicSparseMatrix ( )
inline

The class DynamicSparseMatrix is deprectaed

Definition at line 226 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
EIGEN_DEPRECATED Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::DynamicSparseMatrix ( Index  rows,
Index  cols 
)
inline

The class DynamicSparseMatrix is deprectaed

Definition at line 233 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
template<typename OtherDerived >
EIGEN_DEPRECATED Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::DynamicSparseMatrix ( const SparseMatrixBase< OtherDerived > &  other)
inlineexplicit

The class DynamicSparseMatrix is deprectaed

Definition at line 241 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::DynamicSparseMatrix ( const DynamicSparseMatrix< _Scalar, _Options, _Index > &  other)
inline

Definition at line 247 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::~DynamicSparseMatrix ( )
inline

Destructor

Definition at line 276 of file DynamicSparseMatrix.h.

Member Function Documentation

template<typename _Scalar, int _Options, typename _Index>
std::vector<internal::CompressedStorage<Scalar,Index> >& Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::_data ( )
inline

Definition at line 86 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
const std::vector<internal::CompressedStorage<Scalar,Index> >& Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::_data ( ) const
inline

Definition at line 87 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
Scalar Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::coeff ( Index  row,
Index  col 
) const
inline
Returns
the coefficient value at given position row, col This operation involes a log(rho*outer_size) binary search.

Definition at line 92 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
Scalar& Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::coeffRef ( Index  row,
Index  col 
)
inline
Returns
a reference to the coefficient value at given position row, col This operation involes a log(rho*outer_size) binary search. If the coefficient does not exist yet, then a sorted insertion into a sequential buffer is performed.

Definition at line 103 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
Index Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::cols ( void  ) const
inline

Definition at line 81 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
EIGEN_DEPRECATED void Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::endFill ( )
inline
Deprecated:
use finalize() Does nothing. Provided for compatibility with SparseMatrix.

Definition at line 316 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
EIGEN_DEPRECATED Scalar& Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::fill ( Index  row,
Index  col 
)
inline
Deprecated:
use insert() inserts a nonzero coefficient at given coordinates row, col and returns its reference assuming that: 1 - the coefficient does not exist yet 2 - this the coefficient with greater inner coordinate for the given outer coordinate. In other words, assuming *this is column-major, then there must not exists any nonzero coefficient of coordinates i x col such that i >= row. Otherwise the matrix is invalid.
See also
fillrand(), coeffRef()

Definition at line 297 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
EIGEN_DEPRECATED Scalar& Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::fillrand ( Index  row,
Index  col 
)
inline
Deprecated:
use insert() Like fill() but with random inner coordinates. Compared to the generic coeffRef(), the unique limitation is that we assume the coefficient does not exist yet.

Definition at line 309 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
void Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::finalize ( )
inline

Does nothing: provided for compatibility with SparseMatrix

Definition at line 186 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
Index Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::innerNonZeros ( Index  j) const
inline

Definition at line 84 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
Index Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::innerSize ( ) const
inline

Definition at line 82 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
Scalar& Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::insert ( Index  row,
Index  col 
)
inline

Definition at line 165 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
Scalar& Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::insertBack ( Index  row,
Index  col 
)
inline
Returns
a reference to the non zero coefficient at position row, col assuming that:
  • the nonzero does not already exist
  • the new coefficient is the last one of the given inner vector.
See also
insert, insertBackByOuterInner

Definition at line 150 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
Scalar& Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::insertBackByOuterInner ( Index  outer,
Index  inner 
)
inline
See also
insertBack

Definition at line 156 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
Index Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::nonZeros ( ) const
inline
Returns
the number of non zero coefficients

Definition at line 120 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
DynamicSparseMatrix& Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::operator= ( const DynamicSparseMatrix< _Scalar, _Options, _Index > &  other)
inline

Definition at line 261 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
Index Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::outerSize ( ) const
inline

Definition at line 83 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
void Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::prune ( Scalar  reference,
RealScalar  epsilon = NumTraits<RealScalar>::dummy_precision() 
)
inline

Suppress all nonzeros which are smaller than reference under the tolerence epsilon

Definition at line 189 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
void Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::reserve ( Index  reserveSize = 1000)
inline

Definition at line 130 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
void Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::resize ( Index  rows,
Index  cols 
)
inline

Resize the matrix without preserving the data (the matrix is set to zero)

Definition at line 197 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
void Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::resizeAndKeepData ( Index  rows,
Index  cols 
)
inline

Definition at line 208 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
Index Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::rows ( void  ) const
inline

Definition at line 80 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
void Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::setZero ( )
inline

Definition at line 113 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
EIGEN_DEPRECATED void Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::startFill ( Index  reserveSize = 1000)
inline
Deprecated:
Set the matrix to zero and reserve the memory for reserveSize nonzero coefficients.

Definition at line 282 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
void Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::startVec ( Index  )
inline

Does nothing: provided for compatibility with SparseMatrix

Definition at line 143 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
void Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::swap ( DynamicSparseMatrix< _Scalar, _Options, _Index > &  other)
inline

Definition at line 253 of file DynamicSparseMatrix.h.

Member Data Documentation

template<typename _Scalar, int _Options, typename _Index>
std::vector<internal::CompressedStorage<Scalar,Index> > Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::m_data
protected

Definition at line 76 of file DynamicSparseMatrix.h.

template<typename _Scalar, int _Options, typename _Index>
Index Eigen::DynamicSparseMatrix< _Scalar, _Options, _Index >::m_innerSize
protected

Definition at line 75 of file DynamicSparseMatrix.h.


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


acado
Author(s): Milan Vukov, Rien Quirynen
autogenerated on Mon Jun 10 2019 12:35:33