, including all inherited members.
_ActualLhsType typedef | ProductBase< Derived, Lhs, Rhs > | |
_ActualRhsType typedef | ProductBase< Derived, Lhs, Rhs > | |
_LhsNested typedef | ProductBase< Derived, Lhs, Rhs > | |
_RhsNested typedef | ProductBase< Derived, Lhs, Rhs > | |
ActualLhsType typedef | ProductBase< Derived, Lhs, Rhs > | |
ActualRhsType typedef | ProductBase< Derived, Lhs, Rhs > | |
addTo(Dest &dst) const | ProductBase< Derived, Lhs, Rhs > | [inline] |
adjoint() const | MatrixBase< Derived > | [inline] |
adjointInPlace() | MatrixBase< Derived > | [inline] |
AdjointReturnType typedef | MatrixBase< Derived > | |
all(void) const | DenseBase< Derived > | [inline] |
any(void) const | DenseBase< Derived > | [inline] |
applyHouseholderOnTheLeft(const EssentialPart &essential, const Scalar &tau, Scalar *workspace) | MatrixBase< Derived > | |
applyHouseholderOnTheRight(const EssentialPart &essential, const Scalar &tau, Scalar *workspace) | MatrixBase< Derived > | |
applyOnTheLeft(const EigenBase< OtherDerived > &other) | MatrixBase< Derived > | [inline] |
applyOnTheLeft(Index p, Index q, const JacobiRotation< OtherScalar > &j) | MatrixBase< Derived > | [inline] |
applyOnTheRight(const EigenBase< OtherDerived > &other) | MatrixBase< Derived > | [inline] |
applyOnTheRight(Index p, Index q, const JacobiRotation< OtherScalar > &j) | MatrixBase< Derived > | [inline] |
array() | MatrixBase< Derived > | [inline] |
array() const | MatrixBase< Derived > | [inline] |
asDiagonal() const | MatrixBase< Derived > | [inline] |
asPermutation() const | MatrixBase< Derived > | |
Base typedef | ProductBase< Derived, Lhs, Rhs > | |
BasisReturnType typedef | MatrixBase< Derived > | |
binaryExpr(const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other, const CustomBinaryOp &func=CustomBinaryOp()) const | MatrixBase< Derived > | [inline] |
block(Index startRow, Index startCol, Index blockRows, Index blockCols) | DenseBase< Derived > | [inline] |
block(Index startRow, Index startCol, Index blockRows, Index blockCols) const | DenseBase< Derived > | [inline] |
block(Index startRow, Index startCol) | DenseBase< Derived > | [inline] |
block(Index startRow, Index startCol) const | DenseBase< Derived > | [inline] |
blueNorm() const | MatrixBase< Derived > | [inline] |
bottomLeftCorner(Index cRows, Index cCols) | DenseBase< Derived > | [inline] |
bottomLeftCorner(Index cRows, Index cCols) const | DenseBase< Derived > | [inline] |
bottomLeftCorner() | DenseBase< Derived > | [inline] |
bottomLeftCorner() const | DenseBase< Derived > | [inline] |
bottomRightCorner(Index cRows, Index cCols) | DenseBase< Derived > | [inline] |
bottomRightCorner(Index cRows, Index cCols) const | DenseBase< Derived > | [inline] |
bottomRightCorner() | DenseBase< Derived > | [inline] |
bottomRightCorner() const | DenseBase< Derived > | [inline] |
bottomRows(Index n) | DenseBase< Derived > | [inline] |
bottomRows(Index n) const | DenseBase< Derived > | [inline] |
bottomRows() | DenseBase< Derived > | [inline] |
bottomRows() const | DenseBase< Derived > | [inline] |
cast() const | MatrixBase< Derived > | [inline] |
checkTransposeAliasing(const OtherDerived &other) const | DenseBase< Derived > | [protected] |
coeff(Index row, Index col) const | ProductBase< Derived, Lhs, Rhs > | [inline] |
coeff(Index i) const | ProductBase< Derived, Lhs, Rhs > | [inline] |
CoeffReadCost enum value | DenseBase< Derived > | |
coeffRef(Index row, Index col) const | ProductBase< Derived, Lhs, Rhs > | [inline] |
coeffRef(Index i) const | ProductBase< Derived, Lhs, Rhs > | [inline] |
CoeffReturnType typedef | MatrixBase< Derived > | |
col(Index i) | DenseBase< Derived > | [inline] |
col(Index i) const | DenseBase< Derived > | [inline] |
colPivHouseholderQr() const | MatrixBase< Derived > | |
cols() const | ProductBase< Derived, Lhs, Rhs > | [inline] |
ColsAtCompileTime enum value | DenseBase< Derived > | |
ColsBlockXpr typedef | DenseBase< Derived > | |
colwise() const | DenseBase< Derived > | [inline] |
colwise() | DenseBase< Derived > | [inline] |
ColwiseReturnType typedef | DenseBase< Derived > | |
ColXpr typedef | MatrixBase< Derived > | |
computeInverseAndDetWithCheck(ResultType &inverse, typename ResultType::Scalar &determinant, bool &invertible, const RealScalar &absDeterminantThreshold=NumTraits< Scalar >::dummy_precision()) const | MatrixBase< Derived > | [inline] |
computeInverseWithCheck(ResultType &inverse, bool &invertible, const RealScalar &absDeterminantThreshold=NumTraits< Scalar >::dummy_precision()) const | MatrixBase< Derived > | [inline] |
conjugate() const | MatrixBase< Derived > | [inline] |
ConjugateReturnType typedef | MatrixBase< Derived > | |
Constant(Index rows, Index cols, const Scalar &value) | DenseBase< Derived > | [static] |
Constant(Index size, const Scalar &value) | DenseBase< Derived > | [static] |
Constant(const Scalar &value) | DenseBase< Derived > | [static] |
ConstantReturnType typedef | MatrixBase< Derived > | |
ConstColsBlockXpr typedef | DenseBase< Derived > | |
ConstColwiseReturnType typedef | DenseBase< Derived > | |
ConstColXpr typedef | DenseBase< Derived > | |
ConstDiagonalReturnType typedef | MatrixBase< Derived > | |
ConstReverseReturnType typedef | DenseBase< Derived > | |
ConstRowsBlockXpr typedef | DenseBase< Derived > | |
ConstRowwiseReturnType typedef | DenseBase< Derived > | |
ConstRowXpr typedef | DenseBase< Derived > | |
ConstSegmentReturnType typedef | DenseBase< Derived > | |
ConstStartMinusOne typedef | MatrixBase< Derived > | |
ConstTransposeReturnType typedef | MatrixBase< Derived > | |
cos() const | MatrixBase< Derived > | |
cosh() const | MatrixBase< Derived > | |
count() const | DenseBase< Derived > | [inline] |
cross(const MatrixBase< OtherDerived > &other) const | MatrixBase< Derived > | [inline] |
cross3(const MatrixBase< OtherDerived > &other) const | MatrixBase< Derived > | [inline] |
cwiseAbs() const | MatrixBase< Derived > | [inline] |
cwiseAbs2() const | MatrixBase< Derived > | [inline] |
cwiseEqual(const Scalar &s) const | MatrixBase< Derived > | [inline] |
cwiseEqual(const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const | MatrixBase< Derived > | [inline] |
cwiseInverse() const | MatrixBase< Derived > | [inline] |
cwiseMax(const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const | MatrixBase< Derived > | [inline] |
cwiseMin(const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const | MatrixBase< Derived > | [inline] |
cwiseNotEqual(const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const | MatrixBase< Derived > | [inline] |
cwiseQuotient(const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const | MatrixBase< Derived > | [inline] |
cwiseSqrt() const | MatrixBase< Derived > | [inline] |
DenseBase() | DenseBase< Derived > | [inline, protected] |
determinant() const | MatrixBase< Derived > | [inline] |
diagonal() const | ProductBase< Derived, Lhs, Rhs > | [inline] |
diagonal() const | ProductBase< Derived, Lhs, Rhs > | [inline] |
diagonal(Index index) const | ProductBase< Derived, Lhs, Rhs > | [inline] |
MatrixBase::diagonal() | MatrixBase< Derived > | [inline] |
MatrixBase::diagonal(Index index) | MatrixBase< Derived > | [inline] |
DiagonalReturnType typedef | MatrixBase< Derived > | |
diagonalSize() const | MatrixBase< Derived > | [inline] |
dot(const MatrixBase< OtherDerived > &other) const | MatrixBase< Derived > | |
EIGEN_CWISE_PRODUCT_RETURN_TYPE(Derived, OtherDerived) cwiseProduct(const EIGEN_CURRENT_STORAGE_BASE_CLASS< OtherDerived > &other) const | MatrixBase< Derived > | [inline] |
eigenvalues() const | MatrixBase< Derived > | [inline] |
EigenvaluesReturnType typedef | MatrixBase< Derived > | |
eulerAngles(Index a0, Index a1, Index a2) const | MatrixBase< Derived > | [inline] |
eval() const | DenseBase< Derived > | [inline] |
evalTo(Dest &dst) const | ProductBase< Derived, Lhs, Rhs > | [inline] |
exp() const | MatrixBase< Derived > | |
fill(const Scalar &value) | DenseBase< Derived > | |
flagged() const | DenseBase< Derived > | [inline] |
Flags enum value | DenseBase< Derived > | |
forceAlignedAccess() const | MatrixBase< Derived > | [inline] |
forceAlignedAccess() | MatrixBase< Derived > | [inline] |
forceAlignedAccessIf() const | MatrixBase< Derived > | [inline] |
forceAlignedAccessIf() | MatrixBase< Derived > | [inline] |
format(const IOFormat &fmt) const | DenseBase< Derived > | [inline] |
fullPivHouseholderQr() const | MatrixBase< Derived > | |
fullPivLu() const | MatrixBase< Derived > | [inline] |
FullyLazyCoeffBaseProductType typedef | ProductBase< Derived, Lhs, Rhs > | |
head(Index size) | DenseBase< Derived > | [inline] |
head(Index size) const | DenseBase< Derived > | [inline] |
head() | DenseBase< Derived > | [inline] |
head() const | DenseBase< Derived > | [inline] |
hnormalized() const | MatrixBase< Derived > | [inline] |
HNormalizedReturnType typedef | MatrixBase< Derived > | |
householderQr() const | MatrixBase< Derived > | |
hypotNorm() const | MatrixBase< Derived > | [inline] |
Identity() | MatrixBase< Derived > | [static] |
Identity(Index rows, Index cols) | MatrixBase< Derived > | [static] |
IdentityReturnType typedef | MatrixBase< Derived > | |
imag() const | MatrixBase< Derived > | [inline] |
imag() | MatrixBase< Derived > | [inline] |
ImagReturnType typedef | MatrixBase< Derived > | |
Index typedef | MatrixBase< Derived > | |
innerSize() const | DenseBase< Derived > | [inline] |
InnerSizeAtCompileTime enum value | DenseBase< Derived > | |
InnerStrideAtCompileTime enum value | DenseBase< Derived > | |
inverse() const | MatrixBase< Derived > | [inline] |
isApprox(const DenseBase< OtherDerived > &other, RealScalar prec=NumTraits< Scalar >::dummy_precision()) const | DenseBase< Derived > | |
isApproxToConstant(const Scalar &value, RealScalar prec=NumTraits< Scalar >::dummy_precision()) const | DenseBase< Derived > | |
isConstant(const Scalar &value, RealScalar prec=NumTraits< Scalar >::dummy_precision()) const | DenseBase< Derived > | |
isDiagonal(RealScalar prec=NumTraits< Scalar >::dummy_precision()) const | MatrixBase< Derived > | |
isIdentity(RealScalar prec=NumTraits< Scalar >::dummy_precision()) const | MatrixBase< Derived > | |
isLowerTriangular(RealScalar prec=NumTraits< Scalar >::dummy_precision()) const | MatrixBase< Derived > | |
isMuchSmallerThan(const RealScalar &other, RealScalar prec=NumTraits< Scalar >::dummy_precision()) const | DenseBase< Derived > | |
isMuchSmallerThan(const DenseBase< OtherDerived > &other, RealScalar prec=NumTraits< Scalar >::dummy_precision()) const | DenseBase< Derived > | |
isMuchSmallerThan(const typename NumTraits< Scalar >::Real &other, RealScalar prec) const | DenseBase< Derived > | |
isOnes(RealScalar prec=NumTraits< Scalar >::dummy_precision()) const | DenseBase< Derived > | |
isOrthogonal(const MatrixBase< OtherDerived > &other, RealScalar prec=NumTraits< Scalar >::dummy_precision()) const | MatrixBase< Derived > | |
IsRowMajor enum value | DenseBase< Derived > | |
isUnitary(RealScalar prec=NumTraits< Scalar >::dummy_precision()) const | MatrixBase< Derived > | |
isUpperTriangular(RealScalar prec=NumTraits< Scalar >::dummy_precision()) const | MatrixBase< Derived > | |
IsVectorAtCompileTime enum value | DenseBase< Derived > | |
isZero(RealScalar prec=NumTraits< Scalar >::dummy_precision()) const | DenseBase< Derived > | |
jacobiSvd(unsigned int computationOptions=0) const | MatrixBase< Derived > | |
lazyAssign(const ProductBase< ProductDerived, Lhs, Rhs > &other) | MatrixBase< Derived > | |
DenseBase::lazyAssign(const DenseBase< OtherDerived > &other) | DenseBase< Derived > | |
lazyProduct(const MatrixBase< OtherDerived > &other) const | MatrixBase< Derived > | |
ldlt() const | MatrixBase< Derived > | [inline] |
leftCols(Index n) | DenseBase< Derived > | [inline] |
leftCols(Index n) const | DenseBase< Derived > | [inline] |
leftCols() | DenseBase< Derived > | [inline] |
leftCols() const | DenseBase< Derived > | [inline] |
lhs() const | ProductBase< Derived, Lhs, Rhs > | [inline] |
LhsBlasTraits typedef | ProductBase< Derived, Lhs, Rhs > | |
LhsNested typedef | ProductBase< Derived, Lhs, Rhs > | |
LhsScalar typedef | ProductBase< Derived, Lhs, Rhs > | |
LinSpaced(Sequential_t, Index size, const Scalar &low, const Scalar &high) | DenseBase< Derived > | [static] |
LinSpaced(Index size, const Scalar &low, const Scalar &high) | DenseBase< Derived > | [static] |
LinSpaced(Sequential_t, const Scalar &low, const Scalar &high) | DenseBase< Derived > | [static] |
LinSpaced(const Scalar &low, const Scalar &high) | DenseBase< Derived > | [static] |
llt() const | MatrixBase< Derived > | [inline] |
lpNorm() const | MatrixBase< Derived > | [inline] |
m_lhs | ProductBase< Derived, Lhs, Rhs > | [protected] |
m_result | ProductBase< Derived, Lhs, Rhs > | [mutable, protected] |
m_rhs | ProductBase< Derived, Lhs, Rhs > | [protected] |
makeHouseholder(EssentialPart &essential, Scalar &tau, RealScalar &beta) const | MatrixBase< Derived > | |
makeHouseholderInPlace(Scalar &tau, RealScalar &beta) | MatrixBase< Derived > | |
matrix() | MatrixBase< Derived > | [inline] |
matrix() const | MatrixBase< Derived > | [inline] |
MatrixBase() | MatrixBase< Derived > | [inline, protected] |
matrixFunction(StemFunction f) const | MatrixBase< Derived > | |
maxCoeff() const | DenseBase< Derived > | |
maxCoeff(IndexType *row, IndexType *col) const | DenseBase< Derived > | |
maxCoeff(IndexType *index) const | DenseBase< Derived > | |
MaxColsAtCompileTime enum value | DenseBase< Derived > | |
MaxRowsAtCompileTime enum value | DenseBase< Derived > | |
MaxSizeAtCompileTime enum value | DenseBase< Derived > | |
mean() const | DenseBase< Derived > | |
middleCols(Index startCol, Index numCols) | DenseBase< Derived > | [inline] |
middleCols(Index startCol, Index numCols) const | DenseBase< Derived > | [inline] |
middleCols(Index startCol) | DenseBase< Derived > | [inline] |
middleCols(Index startCol) const | DenseBase< Derived > | [inline] |
middleRows(Index startRow, Index numRows) | DenseBase< Derived > | [inline] |
middleRows(Index startRow, Index numRows) const | DenseBase< Derived > | [inline] |
middleRows(Index startRow) | DenseBase< Derived > | [inline] |
middleRows(Index startRow) const | DenseBase< Derived > | [inline] |
minCoeff() const | DenseBase< Derived > | |
minCoeff(IndexType *row, IndexType *col) const | DenseBase< Derived > | |
minCoeff(IndexType *index) const | DenseBase< Derived > | |
nestByValue() const | DenseBase< Derived > | [inline] |
noalias() | MatrixBase< Derived > | |
NonConstImagReturnType typedef | MatrixBase< Derived > | |
NonConstRealReturnType typedef | MatrixBase< Derived > | |
nonZeros() const | DenseBase< Derived > | [inline] |
norm() const | MatrixBase< Derived > | [inline] |
normalize() | MatrixBase< Derived > | [inline] |
normalized() const | MatrixBase< Derived > | [inline] |
NullaryExpr(Index rows, Index cols, const CustomNullaryOp &func) | DenseBase< Derived > | [static] |
NullaryExpr(Index size, const CustomNullaryOp &func) | DenseBase< Derived > | [static] |
NullaryExpr(const CustomNullaryOp &func) | DenseBase< Derived > | [static] |
Ones(Index rows, Index cols) | DenseBase< Derived > | [static] |
Ones(Index size) | DenseBase< Derived > | [static] |
Ones() | DenseBase< Derived > | [static] |
operator const PlainObject &() const | ProductBase< Derived, Lhs, Rhs > | [inline] |
operator!=(const MatrixBase< OtherDerived > &other) const | MatrixBase< Derived > | [inline] |
operator*(const Scalar &scalar) const | MatrixBase< Derived > | [inline] |
operator*(const std::complex< Scalar > &scalar) const | MatrixBase< Derived > | [inline] |
operator*(const Scalar &scalar, const StorageBaseType &matrix) | MatrixBase< Derived > | [friend] |
operator*(const std::complex< Scalar > &scalar, const StorageBaseType &matrix) | MatrixBase< Derived > | [friend] |
operator*(const MatrixBase< OtherDerived > &other) const | MatrixBase< Derived > | [inline] |
operator*(const DiagonalBase< DiagonalDerived > &diagonal) const | MatrixBase< Derived > | [inline] |
operator*(const UniformScaling< Scalar > &s) const | MatrixBase< Derived > | |
DenseBase::operator*() const | internal::special_scalar_op_base< Derived, internal::traits< Derived >::Scalar, NumTraits< internal::traits< Derived >::Scalar >::Real > | |
operator*=(const EigenBase< OtherDerived > &other) | MatrixBase< Derived > | [inline] |
DenseBase::operator*=(const Scalar &other) | DenseBase< Derived > | [inline] |
operator+=(const MatrixBase< OtherDerived > &other) | MatrixBase< Derived > | |
operator+=(const ArrayBase< OtherDerived > &) | MatrixBase< Derived > | [inline, protected] |
DenseBase::operator+=(const EigenBase< OtherDerived > &other) | DenseBase< Derived > | |
operator-() const | MatrixBase< Derived > | [inline] |
operator-=(const MatrixBase< OtherDerived > &other) | MatrixBase< Derived > | |
operator-=(const ArrayBase< OtherDerived > &) | MatrixBase< Derived > | [inline, protected] |
DenseBase::operator-=(const EigenBase< OtherDerived > &other) | DenseBase< Derived > | |
operator/(const Scalar &scalar) const | MatrixBase< Derived > | [inline] |
operator/=(const Scalar &other) | DenseBase< Derived > | [inline] |
operator<<(const Scalar &s) | DenseBase< Derived > | [inline] |
operator<<(const DenseBase< OtherDerived > &other) | DenseBase< Derived > | [inline] |
operator<<(std::ostream &s, const DenseBase< Derived > &m) | DenseBase< Derived > | [related] |
operator=(const MatrixBase &other) | MatrixBase< Derived > | |
operator=(const DenseBase< OtherDerived > &other) | MatrixBase< Derived > | |
operator=(const EigenBase< OtherDerived > &other) | MatrixBase< Derived > | |
operator=(const ReturnByValue< OtherDerived > &other) | MatrixBase< Derived > | |
DenseBase::operator=(const DenseBase &other) | DenseBase< Derived > | |
operator==(const MatrixBase< OtherDerived > &other) const | MatrixBase< Derived > | [inline] |
operatorNorm() const | MatrixBase< Derived > | [inline] |
outerSize() const | DenseBase< Derived > | [inline] |
OuterStrideAtCompileTime enum value | DenseBase< Derived > | |
PacketScalar typedef | MatrixBase< Derived > | |
partialPivLu() const | MatrixBase< Derived > | [inline] |
PlainObject typedef | ProductBase< Derived, Lhs, Rhs > | |
prod() const | DenseBase< Derived > | |
ProductBase(const Lhs &lhs, const Rhs &rhs) | ProductBase< Derived, Lhs, Rhs > | [inline] |
Random(Index rows, Index cols) | DenseBase< Derived > | [inline, static] |
Random(Index size) | DenseBase< Derived > | [inline, static] |
Random() | DenseBase< Derived > | [inline, static] |
RandomAccessLinSpacedReturnType typedef | DenseBase< Derived > | |
real() const | MatrixBase< Derived > | [inline] |
real() | MatrixBase< Derived > | [inline] |
RealReturnType typedef | MatrixBase< Derived > | |
RealScalar typedef | MatrixBase< Derived > | |
replicate() const | DenseBase< Derived > | [inline] |
replicate(Index rowFacor, Index colFactor) const | DenseBase< Derived > | [inline] |
resize(Index size) | DenseBase< Derived > | [inline] |
resize(Index rows, Index cols) | DenseBase< Derived > | [inline] |
reverse() | DenseBase< Derived > | [inline] |
reverse() const | DenseBase< Derived > | [inline] |
reverseInPlace() | DenseBase< Derived > | [inline] |
ReverseReturnType typedef | DenseBase< Derived > | |
rhs() const | ProductBase< Derived, Lhs, Rhs > | [inline] |
RhsBlasTraits typedef | ProductBase< Derived, Lhs, Rhs > | |
RhsNested typedef | ProductBase< Derived, Lhs, Rhs > | |
RhsScalar typedef | ProductBase< Derived, Lhs, Rhs > | |
rightCols(Index n) | DenseBase< Derived > | [inline] |
rightCols(Index n) const | DenseBase< Derived > | [inline] |
rightCols() | DenseBase< Derived > | [inline] |
rightCols() const | DenseBase< Derived > | [inline] |
row(Index i) | DenseBase< Derived > | [inline] |
row(Index i) const | DenseBase< Derived > | [inline] |
rows() const | ProductBase< Derived, Lhs, Rhs > | [inline] |
RowsAtCompileTime enum value | DenseBase< Derived > | |
RowsBlockXpr typedef | DenseBase< Derived > | |
rowwise() const | DenseBase< Derived > | [inline] |
rowwise() | DenseBase< Derived > | [inline] |
RowwiseReturnType typedef | DenseBase< Derived > | |
RowXpr typedef | MatrixBase< Derived > | |
Scalar typedef | MatrixBase< Derived > | |
ScalarMultipleReturnType typedef | MatrixBase< Derived > | |
ScalarQuotient1ReturnType typedef | MatrixBase< Derived > | |
scaleAndAddTo(Dest &dst, Scalar alpha) const | ProductBase< Derived, Lhs, Rhs > | [inline] |
segment(Index start, Index size) | DenseBase< Derived > | [inline] |
segment(Index start, Index size) const | DenseBase< Derived > | [inline] |
segment(Index start) | DenseBase< Derived > | [inline] |
segment(Index start) const | DenseBase< Derived > | [inline] |
SegmentReturnType typedef | DenseBase< Derived > | |
select(const DenseBase< ThenDerived > &thenMatrix, const DenseBase< ElseDerived > &elseMatrix) const | DenseBase< Derived > | [inline] |
select(const DenseBase< ThenDerived > &thenMatrix, typename ThenDerived::Scalar elseScalar) const | DenseBase< Derived > | [inline] |
select(typename ElseDerived::Scalar thenScalar, const DenseBase< ElseDerived > &elseMatrix) const | DenseBase< Derived > | [inline] |
selfadjointView() | MatrixBase< Derived > | |
selfadjointView() const | MatrixBase< Derived > | |
SequentialLinSpacedReturnType typedef | DenseBase< Derived > | |
setConstant(const Scalar &value) | DenseBase< Derived > | |
setIdentity() | MatrixBase< Derived > | |
setIdentity(Index rows, Index cols) | MatrixBase< Derived > | |
setLinSpaced(Index size, const Scalar &low, const Scalar &high) | DenseBase< Derived > | |
setLinSpaced(const Scalar &low, const Scalar &high) | DenseBase< Derived > | |
setOnes() | DenseBase< Derived > | |
setRandom() | DenseBase< Derived > | [inline] |
setZero() | DenseBase< Derived > | |
sin() const | MatrixBase< Derived > | |
sinh() const | MatrixBase< Derived > | |
SizeAtCompileTime enum value | DenseBase< Derived > | |
SizeMinusOne enum value | MatrixBase< Derived > | |
sparseView(const Scalar &m_reference=Scalar(0), typename NumTraits< Scalar >::Real m_epsilon=NumTraits< Scalar >::dummy_precision()) const | MatrixBase< Derived > | |
squaredNorm() const | MatrixBase< Derived > | |
SquareMatrixType typedef | MatrixBase< Derived > | |
stableNorm() const | MatrixBase< Derived > | [inline] |
StemFunction typedef | MatrixBase< Derived > | |
StorageBaseType typedef | MatrixBase< Derived > | |
StorageKind typedef | MatrixBase< Derived > | |
subTo(Dest &dst) const | ProductBase< Derived, Lhs, Rhs > | [inline] |
sum() const | DenseBase< Derived > | |
swap(const DenseBase< OtherDerived > &other, int=OtherDerived::ThisConstantIsPrivateInPlainObjectBase) | DenseBase< Derived > | [inline] |
swap(PlainObjectBase< OtherDerived > &other) | DenseBase< Derived > | [inline] |
tail(Index size) | DenseBase< Derived > | [inline] |
tail(Index size) const | DenseBase< Derived > | [inline] |
tail() | DenseBase< Derived > | [inline] |
tail() const | DenseBase< Derived > | [inline] |
ThisConstantIsPrivateInPlainObjectBase enum value | DenseBase< Derived > | |
topLeftCorner(Index cRows, Index cCols) | DenseBase< Derived > | [inline] |
topLeftCorner(Index cRows, Index cCols) const | DenseBase< Derived > | [inline] |
topLeftCorner() | DenseBase< Derived > | [inline] |
topLeftCorner() const | DenseBase< Derived > | [inline] |
topRightCorner(Index cRows, Index cCols) | DenseBase< Derived > | [inline] |
topRightCorner(Index cRows, Index cCols) const | DenseBase< Derived > | [inline] |
topRightCorner() | DenseBase< Derived > | [inline] |
topRightCorner() const | DenseBase< Derived > | [inline] |
topRows(Index n) | DenseBase< Derived > | [inline] |
topRows(Index n) const | DenseBase< Derived > | [inline] |
topRows() | DenseBase< Derived > | [inline] |
topRows() const | DenseBase< Derived > | [inline] |
trace() const | MatrixBase< Derived > | |
transpose() | DenseBase< Derived > | [inline] |
transpose() const | DenseBase< Derived > | [inline] |
transposeInPlace() | DenseBase< Derived > | [inline] |
triangularView() | MatrixBase< Derived > | |
triangularView() const | MatrixBase< Derived > | |
unaryExpr(const CustomUnaryOp &func=CustomUnaryOp()) const | MatrixBase< Derived > | [inline] |
unaryViewExpr(const CustomViewOp &func=CustomViewOp()) const | MatrixBase< Derived > | [inline] |
Unit(Index size, Index i) | MatrixBase< Derived > | [static] |
Unit(Index i) | MatrixBase< Derived > | [static] |
unitOrthogonal(void) const | MatrixBase< Derived > | |
UnitW() | MatrixBase< Derived > | [static] |
UnitX() | MatrixBase< Derived > | [static] |
UnitY() | MatrixBase< Derived > | [static] |
UnitZ() | MatrixBase< Derived > | [static] |
value() const | DenseBase< Derived > | [inline] |
visit(Visitor &func) const | DenseBase< Derived > | |
Zero(Index rows, Index cols) | DenseBase< Derived > | [static] |
Zero(Index size) | DenseBase< Derived > | [static] |
Zero() | DenseBase< Derived > | [static] |