Classes | Namespaces
ForwardDeclarations.h File Reference

Go to the source code of this file.

Classes

struct  Eigen::internal::accessors_level< Derived >
 
class  Eigen::AngleAxis< _Scalar >
 Represents a 3D rotation as a rotation angle around an arbitrary 3D axis. More...
 
class  Eigen::Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >
 General-purpose arrays with easy API for coefficient-wise operations. More...
 
class  Eigen::ArrayBase< Derived >
 Base class for all 1D and 2D array, and related expressions. More...
 
class  Eigen::ArrayWrapper< ExpressionType >
 Expression of a mathematical vector or matrix as an array object. More...
 
class  Eigen::internal::BandMatrix< _Scalar, Rows, Cols, Supers, Subs, Options >
 Represents a rectangular matrix with a banded storage. More...
 
class  Eigen::Block< XprType, BlockRows, BlockCols, InnerPanel >
 Expression of a fixed-size or dynamic-size block. More...
 
class  Eigen::CoeffBasedProduct< LhsNested, RhsNested, NestingFlags >
 
class  Eigen::ColPivHouseholderQR< _MatrixType >
 Householder rank-revealing QR decomposition of a matrix with column-pivoting. More...
 
class  Eigen::CommaInitializer< XprType >
 Helper class used by the comma initializer operator. More...
 
struct  Eigen::internal::conj_helper< LhsScalar, RhsScalar, ConjLhs, ConjRhs >
 
class  Eigen::Conjugate< MatrixType >
 
class  Eigen::Cross< Lhs, Rhs >
 
class  Eigen::CwiseBinaryOp< BinaryOp, Lhs, Rhs >
 Generic expression where a coefficient-wise binary operator is applied to two expressions. More...
 
class  Eigen::CwiseNullaryOp< NullaryOp, PlainObjectType >
 Generic expression of a matrix where all coefficients are defined by a functor. More...
 
class  Eigen::CwiseUnaryOp< UnaryOp, XprType >
 Generic expression where a coefficient-wise unary operator is applied to an expression. More...
 
class  Eigen::CwiseUnaryView< ViewOp, MatrixType >
 Generic lvalue expression of a coefficient-wise unary operator of a matrix or a vector. More...
 
class  Eigen::DenseBase< Derived >
 Base class for all dense matrices, vectors, and arrays. More...
 
class  Eigen::DenseCoeffsBase< Derived, Level >
 
class  Eigen::Diagonal< MatrixType, _DiagIndex >
 Expression of a diagonal/subdiagonal/superdiagonal in a matrix. More...
 
class  Eigen::DiagonalBase< Derived >
 
class  Eigen::DiagonalMatrix< _Scalar, SizeAtCompileTime, MaxSizeAtCompileTime >
 Represents a diagonal matrix with its storage. More...
 
class  Eigen::DiagonalProduct< MatrixType, DiagonalType, ProductOrder >
 
class  Eigen::DiagonalWrapper< _DiagonalVectorType >
 Expression of a diagonal matrix. More...
 
struct  Eigen::EigenBase< Derived >
 
class  Eigen::Flagged< ExpressionType, Added, Removed >
 Expression with modified flags. More...
 
class  Eigen::ForceAlignedAccess< ExpressionType >
 Enforce aligned packet loads and stores regardless of what is requested. More...
 
class  Eigen::FullPivHouseholderQR< _MatrixType >
 Householder rank-revealing QR decomposition of a matrix with full pivoting. More...
 
class  Eigen::FullPivLU< _MatrixType >
 LU decomposition of a matrix with complete pivoting, and related features. More...
 
class  Eigen::GeneralProduct< Lhs, Rhs, ProductType >
 Expression of the product of two general matrices or vectors. More...
 
struct  Eigen::internal::has_direct_access< Derived >
 
class  Eigen::HouseholderQR< _MatrixType >
 Householder QR decomposition of a matrix. More...
 
class  Eigen::HouseholderSequence< VectorsType, CoeffsType, Side >
 Sequence of Householder reflections acting on subspaces with decreasing size. More...
 
struct  Eigen::internal::image_retval< DecompositionType >
 
class  Eigen::internal::image_retval_base< _DecompositionType >
 
struct  Eigen::internal::inverse_impl< MatrixType >
 
class  Eigen::JacobiRotation< Scalar >
 Rotation given by a cosine-sine pair. More...
 
class  Eigen::JacobiSVD< _MatrixType, QRPreconditioner >
 Two-sided Jacobi SVD decomposition of a rectangular matrix. More...
 
struct  Eigen::internal::kernel_retval< DecompositionType >
 
class  Eigen::internal::kernel_retval_base< _DecompositionType >
 
struct  Eigen::LazyProductReturnType< Lhs, Rhs >
 
class  Eigen::LDLT< _MatrixType, _UpLo >
 Robust Cholesky decomposition of a matrix with pivoting. More...
 
class  Eigen::LLT< _MatrixType, _UpLo >
 Standard Cholesky decomposition (LL^T) of a matrix and associated features. More...
 
class  Eigen::Map< PlainObjectType, MapOptions, StrideType >
 A matrix or vector expression mapping an existing array of data. More...
 
class  Eigen::MapBase< Derived, Level >
 Base class for Map and Block expression with direct access. More...
 
class  Eigen::Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >
 The matrix class, also used for vectors and row-vectors. More...
 
class  Eigen::MatrixBase< Derived >
 Base class for all dense matrices, vectors, and expressions. More...
 
struct  Eigen::MatrixExponentialReturnValue< Derived >
 Proxy for the matrix exponential of some matrix (expression). More...
 
class  Eigen::MatrixFunctionReturnValue< Derived >
 Proxy for the matrix function of some matrix (expression). More...
 
class  Eigen::MatrixLogarithmReturnValue< Derived >
 Proxy for the matrix logarithm of some matrix (expression). More...
 
class  Eigen::MatrixPowerProduct< Derived, Lhs, Rhs >
 
class  Eigen::MatrixPowerReturnValue< Derived >
 Proxy for the matrix power of some matrix (expression). More...
 
class  Eigen::MatrixSquareRootReturnValue< Derived >
 Proxy for the matrix square root of some matrix (expression). More...
 
class  Eigen::MatrixWrapper< ExpressionType >
 Expression of an array as a mathematical vector or matrix. More...
 
class  Eigen::NestByValue< ExpressionType >
 Expression which must be nested by value. More...
 
class  Eigen::NoAlias< ExpressionType, StorageBase >
 Pseudo expression providing an operator = assuming no aliasing. More...
 
class  Eigen::NumTraits< T >
 Holds information about the various numeric (i.e. scalar) types allowed by Eigen. More...
 
class  Eigen::PartialPivLU< _MatrixType >
 LU decomposition of a matrix with partial pivoting, and related features. More...
 
class  Eigen::PartialReduxExpr< MatrixType, MemberOp, Direction >
 Generic expression of a partially reduxed matrix. More...
 
class  Eigen::PermutationBase< Derived >
 Base class for permutations. More...
 
class  Eigen::PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, IndexType >
 Permutation matrix. More...
 
class  Eigen::PermutationWrapper< _IndicesType >
 Class to view a vector of integers as a permutation matrix. More...
 
class  Eigen::PlainObjectBase< Derived >
 Dense storage base class for matrices and arrays. More...
 
struct  Eigen::internal::product_type< Lhs, Rhs >
 
class  Eigen::ProductBase< Derived, Lhs, Rhs >
 
class  Eigen::ProductReturnType< Lhs, Rhs, ProductType >
 Helper class to get the correct and optimized returned type of operator*. More...
 
class  Eigen::QuaternionBase< Derived >
 Base class for quaternion expressions. More...
 
class  Eigen::Replicate< MatrixType, RowFactor, ColFactor >
 Expression of the multiple replication of a matrix or vector. More...
 
class  Eigen::ReturnByValue< Derived >
 
class  Eigen::Reverse< MatrixType, Direction >
 Expression of the reverse of a vector or matrix. More...
 
class  Eigen::Rotation2D< _Scalar >
 Represents a rotation/orientation in a 2 dimensional space. More...
 
class  Eigen::RotationBase< Derived, _Dim >
 Common base class for compact rotation representations. More...
 
struct  Eigen::internal::scalar_abs2_op< Scalar >
 
struct  Eigen::internal::scalar_abs_op< Scalar >
 
struct  Eigen::internal::scalar_acos_op< Scalar >
 
struct  Eigen::internal::scalar_add_op< Scalar >
 
struct  Eigen::internal::scalar_asin_op< Scalar >
 
struct  Eigen::internal::scalar_cast_op< Scalar, NewType >
 
struct  Eigen::internal::scalar_conj_product_op< LhsScalar, RhsScalar >
 
struct  Eigen::internal::scalar_conjugate_op< Scalar >
 
struct  Eigen::internal::scalar_constant_op< Scalar >
 
struct  Eigen::internal::scalar_cos_op< Scalar >
 
struct  Eigen::internal::scalar_cube_op< Scalar >
 
struct  Eigen::internal::scalar_difference_op< Scalar >
 
struct  Eigen::internal::scalar_exp_op< Scalar >
 
struct  Eigen::internal::scalar_identity_op< Scalar >
 
struct  Eigen::internal::scalar_imag_op< Scalar >
 
struct  Eigen::internal::scalar_inverse_op< Scalar >
 
struct  Eigen::internal::scalar_log_op< Scalar >
 
struct  Eigen::internal::scalar_max_op< Scalar >
 
struct  Eigen::internal::scalar_min_op< Scalar >
 
struct  Eigen::internal::scalar_multiple2_op< Scalar1, Scalar2 >
 
struct  Eigen::internal::scalar_multiple_op< Scalar >
 
struct  Eigen::internal::scalar_opposite_op< Scalar >
 
struct  Eigen::internal::scalar_pow_op< Scalar >
 
struct  Eigen::internal::scalar_product_op< LhsScalar, RhsScalar >
 
struct  Eigen::internal::scalar_quotient1_op< Scalar >
 
struct  Eigen::internal::scalar_quotient_op< LhsScalar, RhsScalar >
 
struct  Eigen::internal::scalar_random_op< Scalar >
 
struct  Eigen::internal::scalar_real_op< Scalar >
 
struct  Eigen::internal::scalar_sin_op< Scalar >
 
struct  Eigen::internal::scalar_sqrt_op< Scalar >
 
struct  Eigen::internal::scalar_square_op< Scalar >
 
struct  Eigen::internal::scalar_sum_op< Scalar >
 
struct  Eigen::internal::scalar_tan_op< Scalar >
 
class  Eigen::Select< ConditionMatrixType, ThenMatrixType, ElseMatrixType >
 Expression of a coefficient wise version of the C++ ternary operator ?: More...
 
class  Eigen::SelfAdjointView< MatrixType, UpLo >
 Expression of a selfadjoint matrix from a triangular part of a dense matrix. More...
 
class  Eigen::SelfCwiseBinaryOp< BinaryOp, Lhs, Rhs >
 
struct  Eigen::internal::solve_retval< DecompositionType, Rhs >
 
class  Eigen::internal::solve_retval_base< _DecompositionType, Rhs >
 
class  Eigen::SparseView< MatrixType >
 
struct  Eigen::internal::stem_function< Scalar >
 
class  Eigen::Stride< _OuterStrideAtCompileTime, _InnerStrideAtCompileTime >
 Holds strides information for Map. More...
 
class  Eigen::SwapWrapper< ExpressionType >
 
struct  Eigen::internal::traits< T >
 
struct  Eigen::internal::traits< const T >
 
class  Eigen::Translation< _Scalar, _Dim >
 Represents a translation transformation. More...
 
class  Eigen::Transpose< MatrixType >
 Expression of the transpose of a matrix. More...
 
class  Eigen::Transpositions< SizeAtCompileTime, MaxSizeAtCompileTime, IndexType >
 Represents a sequence of transpositions (row/column interchange) More...
 
class  Eigen::TranspositionsBase< Derived >
 
class  Eigen::TranspositionsWrapper< _IndicesType >
 
class  Eigen::TriangularBase< Derived >
 
class  Eigen::TriangularView< _MatrixType, _Mode >
 Base class for triangular part in a matrix. More...
 
class  Eigen::VectorBlock< VectorType, Size >
 Expression of a fixed-size or dynamic-size sub-vector. More...
 
class  Eigen::VectorwiseOp< ExpressionType, Direction >
 Pseudo expression providing partial reduction operations. More...
 
class  Eigen::WithFormat< ExpressionType >
 Pseudo expression providing matrix output with given format. More...
 

Namespaces

 Eigen
 iterative scaling algorithm to equilibrate rows and column norms in matrices
 
 Eigen::internal
 


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