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