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

a sparse vector class More...

#include <SparseUtil.h>

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

Classes

class  InnerIterator
 
class  ReverseInnerIterator
 

Public Types

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

EIGEN_DEPRECATED Storage_data ()
 
EIGEN_DEPRECATED const Storage_data () const
 
Scalar coeff (Index row, Index col) const
 
Scalar coeff (Index i) const
 
ScalarcoeffRef (Index row, Index col)
 
ScalarcoeffRef (Index i)
 
EIGEN_STRONG_INLINE Index cols () const
 
Storagedata ()
 
const Storagedata () const
 
EIGEN_DEPRECATED void endFill ()
 
EIGEN_DEPRECATED Scalarfill (Index r, Index c)
 
EIGEN_DEPRECATED Scalarfill (Index i)
 
EIGEN_DEPRECATED Scalarfillrand (Index r, Index c)
 
EIGEN_DEPRECATED Scalarfillrand (Index i)
 
void finalize ()
 
EIGEN_STRONG_INLINE const IndexinnerIndexPtr () const
 
EIGEN_STRONG_INLINE IndexinnerIndexPtr ()
 
EIGEN_STRONG_INLINE Index innerSize () const
 
Scalarinsert (Index row, Index col)
 
Scalarinsert (Index i)
 
ScalarinsertBack (Index i)
 
ScalarinsertBackByOuterInner (Index outer, Index inner)
 
Index nonZeros () const
 
SparseVectoroperator= (const SparseVector &other)
 
template<typename OtherDerived >
SparseVectoroperator= (const SparseMatrixBase< OtherDerived > &other)
 
template<typename Lhs , typename Rhs >
SparseVectoroperator= (const SparseSparseProduct< Lhs, Rhs > &product)
 
EIGEN_STRONG_INLINE Index outerSize () const
 
void prune (const Scalar &reference, const RealScalar &epsilon=NumTraits< RealScalar >::dummy_precision())
 
void reserve (Index reserveSize)
 
void resize (Index rows, Index cols)
 
void resize (Index newSize)
 
void resizeNonZeros (Index size)
 
EIGEN_STRONG_INLINE Index rows () const
 
void setZero ()
 
 SparseVector ()
 
 SparseVector (Index size)
 
 SparseVector (Index rows, Index cols)
 
template<typename OtherDerived >
 SparseVector (const SparseMatrixBase< OtherDerived > &other)
 
 SparseVector (const SparseVector &other)
 
EIGEN_DEPRECATED void startFill (Index reserve)
 
void startVec (Index outer)
 
Scalar sum () const
 
void swap (SparseVector &other)
 
EIGEN_STRONG_INLINE const ScalarvaluePtr () const
 
EIGEN_STRONG_INLINE ScalarvaluePtr ()
 
 ~SparseVector ()
 
- Public Member Functions inherited from Eigen::SparseMatrixBase< SparseVector< _Scalar, _Options, _Index > >
const AdjointReturnType adjoint () const
 
EIGEN_STRONG_INLINE const CwiseBinaryOp< CustomBinaryOp, const SparseVector< _Scalar, _Options, _Index >, const OtherDerived > binaryExpr (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other, const CustomBinaryOp &func=CustomBinaryOp()) const
 
Block< SparseVector< _Scalar, _Options, _Index > > block (Index startRow, Index startCol, Index blockRows, Index blockCols)
 
const Block< const SparseVector< _Scalar, _Options, _Index > > block (Index startRow, Index startCol, Index blockRows, Index blockCols) const
 
Block< SparseVector< _Scalar, _Options, _Index >, BlockRows, BlockCols > block (Index startRow, Index startCol)
 
const Block< const SparseVector< _Scalar, _Options, _Index >, BlockRows, BlockCols > block (Index startRow, Index startCol) const
 
Block< SparseVector< _Scalar, _Options, _Index >, BlockRows, BlockCols > block (Index startRow, Index startCol, Index blockRows, Index blockCols)
 
const Block< const SparseVector< _Scalar, _Options, _Index >, BlockRows, BlockCols > block (Index startRow, Index startCol, Index blockRows, Index blockCols) const
 
RealScalar blueNorm () const
 
Block< SparseVector< _Scalar, _Options, _Index > > bottomLeftCorner (Index cRows, Index cCols)
 
const Block< const SparseVector< _Scalar, _Options, _Index > > bottomLeftCorner (Index cRows, Index cCols) const
 
Block< SparseVector< _Scalar, _Options, _Index >, CRows, CCols > bottomLeftCorner ()
 
const Block< const SparseVector< _Scalar, _Options, _Index >, CRows, CCols > bottomLeftCorner () const
 
Block< SparseVector< _Scalar, _Options, _Index >, CRows, CCols > bottomLeftCorner (Index cRows, Index cCols)
 
const Block< const SparseVector< _Scalar, _Options, _Index >, CRows, CCols > bottomLeftCorner (Index cRows, Index cCols) const
 
Block< SparseVector< _Scalar, _Options, _Index > > bottomRightCorner (Index cRows, Index cCols)
 
const Block< const SparseVector< _Scalar, _Options, _Index > > bottomRightCorner (Index cRows, Index cCols) const
 
Block< SparseVector< _Scalar, _Options, _Index >, CRows, CCols > bottomRightCorner ()
 
const Block< const SparseVector< _Scalar, _Options, _Index >, CRows, CCols > bottomRightCorner () const
 
Block< SparseVector< _Scalar, _Options, _Index >, CRows, CCols > bottomRightCorner (Index cRows, Index cCols)
 
const Block< const SparseVector< _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< SparseVector< _Scalar, _Options, _Index >, const CwiseUnaryOp< internal::scalar_cast_op< typename internal::traits< SparseVector< _Scalar, _Options, _Index > >::Scalar, NewType >, const SparseVector< _Scalar, _Options, _Index > > >::type cast () const
 
ColXpr col (Index i)
 
ConstColXpr col (Index i) const
 
Index cols () const
 
ConjugateReturnType conjugate () const
 
SparseVector< _Scalar, _Options, _Index > & const_cast_derived () const
 
EIGEN_STRONG_INLINE const CwiseUnaryOp< internal::scalar_abs_op< Scalar >, const SparseVector< _Scalar, _Options, _Index > > cwiseAbs () const
 
EIGEN_STRONG_INLINE const CwiseUnaryOp< internal::scalar_abs2_op< Scalar >, const SparseVector< _Scalar, _Options, _Index > > cwiseAbs2 () const
 
const CwiseBinaryOp< std::equal_to< Scalar >, const SparseVector< _Scalar, _Options, _Index >, const OtherDerived > cwiseEqual (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
const CwiseUnaryOp< std::binder1st< std::equal_to< Scalar > >, const SparseVector< _Scalar, _Options, _Index > > cwiseEqual (const Scalar &s) const
 
const CwiseUnaryOp< internal::scalar_inverse_op< Scalar >, const SparseVector< _Scalar, _Options, _Index > > cwiseInverse () const
 
EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_max_op< Scalar >, const SparseVector< _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 SparseVector< _Scalar, _Options, _Index >, const ConstantReturnTypecwiseMax (const Scalar &other) const
 
EIGEN_STRONG_INLINE const CwiseBinaryOp< internal::scalar_min_op< Scalar >, const SparseVector< _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 SparseVector< _Scalar, _Options, _Index >, const ConstantReturnTypecwiseMin (const Scalar &other) const
 
const CwiseBinaryOp< std::not_equal_to< Scalar >, const SparseVector< _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 SparseVector< _Scalar, _Options, _Index >, const OtherDerived > cwiseQuotient (const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
const CwiseUnaryOp< internal::scalar_sqrt_op< Scalar >, const SparseVector< _Scalar, _Options, _Index > > cwiseSqrt () const
 
const SparseVector< _Scalar, _Options, _Index > & derived () const
 
SparseVector< _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 (SparseVector< _Scalar, _Options, _Index >, OtherDerived) cwiseProduct(const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const
 
const internal::eval< SparseVector< _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< SparseVector< _Scalar, _Options, _Index >, Dynamic, Dynamic, true > innerVectors (Index outerStart, Index outerSize)
 
const Block< const SparseVector< _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
 
SparseVector< _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 SparseVector< _Scalar, _Options, _Index > > operator* (const std::complex< Scalar > &scalar) const
 
const SparseSparseProductReturnType< SparseVector< _Scalar, _Options, _Index >, OtherDerived >::Type operator* (const SparseMatrixBase< OtherDerived > &other) const
 
const SparseDiagonalProduct< SparseVector< _Scalar, _Options, _Index >, OtherDerived > operator* (const DiagonalBase< OtherDerived > &other) const
 
const SparseDenseProductReturnType< SparseVector< _Scalar, _Options, _Index >, OtherDerived >::Type operator* (const MatrixBase< OtherDerived > &other) const
 
SparseVector< _Scalar, _Options, _Index > & operator*= (const Scalar &other)
 
SparseVector< _Scalar, _Options, _Index > & operator*= (const SparseMatrixBase< OtherDerived > &other)
 
SparseVector< _Scalar, _Options, _Index > & operator+= (const SparseMatrixBase< OtherDerived > &other)
 
const CwiseUnaryOp< internal::scalar_opposite_op< typename internal::traits< SparseVector< _Scalar, _Options, _Index > >::Scalar >, const SparseVector< _Scalar, _Options, _Index > > operator- () const
 
SparseVector< _Scalar, _Options, _Index > & operator-= (const SparseMatrixBase< OtherDerived > &other)
 
const CwiseUnaryOp< internal::scalar_quotient1_op< typename internal::traits< SparseVector< _Scalar, _Options, _Index > >::Scalar >, const SparseVector< _Scalar, _Options, _Index > > operator/ (const Scalar &scalar) const
 
SparseVector< _Scalar, _Options, _Index > & operator/= (const Scalar &other)
 
SparseVector< _Scalar, _Options, _Index > & operator= (const EigenBase< OtherDerived > &other)
 
SparseVector< _Scalar, _Options, _Index > & operator= (const ReturnByValue< OtherDerived > &other)
 
SparseVector< _Scalar, _Options, _Index > & operator= (const SparseMatrixBase< OtherDerived > &other)
 
SparseVector< _Scalar, _Options, _Index > & operator= (const SparseVector< _Scalar, _Options, _Index > &other)
 
SparseVector< _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< SparseVector< _Scalar, _Options, _Index >, UpLo > selfadjointView () const
 
SparseSelfAdjointView< SparseVector< _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< SparseVector< _Scalar, _Options, _Index > > topLeftCorner (Index cRows, Index cCols)
 
const Block< const SparseVector< _Scalar, _Options, _Index > > topLeftCorner (Index cRows, Index cCols) const
 
Block< SparseVector< _Scalar, _Options, _Index >, CRows, CCols > topLeftCorner ()
 
const Block< const SparseVector< _Scalar, _Options, _Index >, CRows, CCols > topLeftCorner () const
 
Block< SparseVector< _Scalar, _Options, _Index >, CRows, CCols > topLeftCorner (Index cRows, Index cCols)
 
const Block< const SparseVector< _Scalar, _Options, _Index >, CRows, CCols > topLeftCorner (Index cRows, Index cCols) const
 
Block< SparseVector< _Scalar, _Options, _Index > > topRightCorner (Index cRows, Index cCols)
 
const Block< const SparseVector< _Scalar, _Options, _Index > > topRightCorner (Index cRows, Index cCols) const
 
Block< SparseVector< _Scalar, _Options, _Index >, CRows, CCols > topRightCorner ()
 
const Block< const SparseVector< _Scalar, _Options, _Index >, CRows, CCols > topRightCorner () const
 
Block< SparseVector< _Scalar, _Options, _Index >, CRows, CCols > topRightCorner (Index cRows, Index cCols)
 
const Block< const SparseVector< _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< SparseVector< _Scalar, _Options, _Index > > transpose ()
 
const Transpose< const SparseVector< _Scalar, _Options, _Index > > transpose () const
 
const SparseTriangularView< SparseVector< _Scalar, _Options, _Index >, Mode > triangularView () const
 
SparseSymmetricPermutationProduct< SparseVector< _Scalar, _Options, _Index >, Upper|Lower > twistedBy (const PermutationMatrix< Dynamic, Dynamic, Index > &perm) const
 
const CwiseUnaryOp< CustomUnaryOp, const SparseVector< _Scalar, _Options, _Index > > unaryExpr (const CustomUnaryOp &func=CustomUnaryOp()) const
 Apply a unary operator coefficient-wise. More...
 
const CwiseUnaryView< CustomViewOp, const SparseVector< _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
 

Static Protected Member Functions

static void check_template_parameters ()
 

Protected Attributes

Storage m_data
 
Index m_size
 
- Protected Attributes inherited from Eigen::SparseMatrixBase< SparseVector< _Scalar, _Options, _Index > >
bool m_isRValue
 

Private Types

typedef SparseMatrixBase< SparseVectorSparseBase
 

Friends

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

Additional Inherited Members

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

Detailed Description

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

a sparse vector class

Template Parameters
_Scalarthe scalar type, i.e. the type of the coefficients

See http://www.netlib.org/linalg/html_templates/node91.html for details on the storage scheme.

This class can be extended with the help of the plugin mechanism described on the page TopicCustomizingEigen by defining the preprocessor symbol EIGEN_SPARSEVECTOR_PLUGIN.

Definition at line 73 of file SparseUtil.h.

Member Typedef Documentation

template<typename _Scalar , int _Options, typename _Index >
typedef SparseMatrixBase<SparseVector> Eigen::SparseVector< _Scalar, _Options, _Index >::SparseBase
private

Definition at line 68 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
typedef internal::CompressedStorage<Scalar,Index> Eigen::SparseVector< _Scalar, _Options, _Index >::Storage

Definition at line 75 of file SparseVector.h.

Member Enumeration Documentation

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

Definition at line 76 of file SparseVector.h.

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

Definition at line 78 of file SparseVector.h.

Constructor & Destructor Documentation

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

Definition at line 210 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
Eigen::SparseVector< _Scalar, _Options, _Index >::SparseVector ( Index  size)
inline

Definition at line 212 of file SparseVector.h.

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

Definition at line 214 of file SparseVector.h.

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

Definition at line 217 of file SparseVector.h.

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

Definition at line 224 of file SparseVector.h.

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

Destructor

Definition at line 281 of file SparseVector.h.

Member Function Documentation

template<typename _Scalar , int _Options, typename _Index >
EIGEN_DEPRECATED Storage& Eigen::SparseVector< _Scalar, _Options, _Index >::_data ( )
inline

Definition at line 327 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
EIGEN_DEPRECATED const Storage& Eigen::SparseVector< _Scalar, _Options, _Index >::_data ( ) const
inline

Definition at line 329 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
static void Eigen::SparseVector< _Scalar, _Options, _Index >::check_template_parameters ( )
inlinestaticprotected

Definition at line 337 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
Scalar Eigen::SparseVector< _Scalar, _Options, _Index >::coeff ( Index  row,
Index  col 
) const
inline

Definition at line 98 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
Scalar Eigen::SparseVector< _Scalar, _Options, _Index >::coeff ( Index  i) const
inline

Definition at line 103 of file SparseVector.h.

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

Definition at line 109 of file SparseVector.h.

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

This insertion might be very costly if the number of nonzeros above i is large.

Definition at line 121 of file SparseVector.h.

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

Definition at line 83 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
Storage& Eigen::SparseVector< _Scalar, _Options, _Index >::data ( )
inline

Definition at line 94 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
const Storage& Eigen::SparseVector< _Scalar, _Options, _Index >::data ( ) const
inline

Definition at line 96 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
EIGEN_DEPRECATED void Eigen::SparseVector< _Scalar, _Options, _Index >::endFill ( )
inline

Definition at line 323 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
EIGEN_DEPRECATED Scalar& Eigen::SparseVector< _Scalar, _Options, _Index >::fill ( Index  r,
Index  c 
)
inline

Definition at line 296 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
EIGEN_DEPRECATED Scalar& Eigen::SparseVector< _Scalar, _Options, _Index >::fill ( Index  i)
inline

Definition at line 303 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
EIGEN_DEPRECATED Scalar& Eigen::SparseVector< _Scalar, _Options, _Index >::fillrand ( Index  r,
Index  c 
)
inline

Definition at line 310 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
EIGEN_DEPRECATED Scalar& Eigen::SparseVector< _Scalar, _Options, _Index >::fillrand ( Index  i)
inline

Definition at line 317 of file SparseVector.h.

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

Definition at line 189 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
EIGEN_STRONG_INLINE const Index* Eigen::SparseVector< _Scalar, _Options, _Index >::innerIndexPtr ( ) const
inline

Definition at line 90 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
EIGEN_STRONG_INLINE Index* Eigen::SparseVector< _Scalar, _Options, _Index >::innerIndexPtr ( )
inline

Definition at line 91 of file SparseVector.h.

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

Definition at line 84 of file SparseVector.h.

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

Definition at line 155 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
Scalar& Eigen::SparseVector< _Scalar, _Options, _Index >::insert ( Index  i)
inline

Definition at line 164 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
Scalar& Eigen::SparseVector< _Scalar, _Options, _Index >::insertBack ( Index  i)
inline

Definition at line 149 of file SparseVector.h.

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

Definition at line 143 of file SparseVector.h.

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

Definition at line 135 of file SparseVector.h.

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

Definition at line 241 of file SparseVector.h.

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

Definition at line 256 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
template<typename Lhs , typename Rhs >
SparseVector& Eigen::SparseVector< _Scalar, _Options, _Index >::operator= ( const SparseSparseProduct< Lhs, Rhs > &  product)
inline

Definition at line 266 of file SparseVector.h.

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

Definition at line 85 of file SparseVector.h.

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

Definition at line 191 of file SparseVector.h.

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

Definition at line 186 of file SparseVector.h.

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

Definition at line 196 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
void Eigen::SparseVector< _Scalar, _Options, _Index >::resize ( Index  newSize)
inline

Definition at line 202 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
void Eigen::SparseVector< _Scalar, _Options, _Index >::resizeNonZeros ( Index  size)
inline

Definition at line 208 of file SparseVector.h.

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

Definition at line 82 of file SparseVector.h.

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

Definition at line 132 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
EIGEN_DEPRECATED void Eigen::SparseVector< _Scalar, _Options, _Index >::startFill ( Index  reserve)
inline

Definition at line 289 of file SparseVector.h.

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

Definition at line 137 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
internal::traits< SparseVector< _Scalar, _Options, _Index > >::Scalar Eigen::SparseVector< _Scalar, _Options, _Index >::sum ( ) const

Overloaded for performance

Definition at line 37 of file SparseRedux.h.

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

Swaps the values of *this and other. Overloaded for performance: this version performs a shallow swap by swaping pointers and attributes only.

See also
SparseMatrixBase::swap()

Definition at line 235 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
EIGEN_STRONG_INLINE const Scalar* Eigen::SparseVector< _Scalar, _Options, _Index >::valuePtr ( ) const
inline

Definition at line 87 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
EIGEN_STRONG_INLINE Scalar* Eigen::SparseVector< _Scalar, _Options, _Index >::valuePtr ( )
inline

Definition at line 88 of file SparseVector.h.

Friends And Related Function Documentation

template<typename _Scalar , int _Options, typename _Index >
std::ostream& operator<< ( std::ostream &  s,
const SparseVector< _Scalar, _Options, _Index > &  m 
)
friend

Definition at line 272 of file SparseVector.h.

Member Data Documentation

template<typename _Scalar , int _Options, typename _Index >
Storage Eigen::SparseVector< _Scalar, _Options, _Index >::m_data
protected

Definition at line 343 of file SparseVector.h.

template<typename _Scalar , int _Options, typename _Index >
Index Eigen::SparseVector< _Scalar, _Options, _Index >::m_size
protected

Definition at line 344 of file SparseVector.h.


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


tuw_aruco
Author(s): Lukas Pfeifhofer
autogenerated on Mon Jun 10 2019 15:41:11