12 #ifndef EIGEN_COMPLEX_EIGEN_SOLVER_H    13 #define EIGEN_COMPLEX_EIGEN_SOLVER_H    61     typedef typename MatrixType::Scalar 
Scalar;
    63     typedef typename MatrixType::Index 
Index;
   126             : 
m_eivec(matrix.rows(),matrix.cols()),
   131               m_matX(matrix.rows(),matrix.cols())
   133       compute(matrix, computeEigenvectors);
   250 template<
typename MatrixType>
   264     if(computeEigenvectors)
   275 template<
typename MatrixType>
   282   m_matX = EigenvectorType::Zero(n, n);
   283   for(
Index k=n-1 ; k>=0 ; k--)
   287     for(
Index i=k-1 ; i>=0 ; i--)
   306   for(
Index k=0 ; k<n ; k++)
   313 template<
typename MatrixType>
   317   for (
Index i=0; i<n; i++)
   325       if(computeEigenvectors)
   333 #endif // EIGEN_COMPLEX_EIGEN_SOLVER_H 
ComplexSchur< MatrixType > m_schur
void swap(MatrixBase< OtherDerived > const &other)
ComplexSchur & setMaxIterations(Index maxIters)
Sets the maximum number of iterations allowed. 
ComplexEigenSolver(Index size)
Default Constructor with memory preallocation. 
ComplexSchur & compute(const MatrixType &matrix, bool computeU=true)
Computes Schur decomposition of given matrix. 
Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 > EigenvalueType
Type for vector of eigenvalues as returned by eigenvalues(). 
EigenvalueType m_eivalues
Holds information about the various numeric (i.e. scalar) types allowed by Eigen. ...
MatrixType::Scalar Scalar
Scalar type for matrices of type MatrixType. 
Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime > EigenvectorType
Type for matrix of eigenvectors as returned by eigenvectors(). 
ComputationInfo info() const 
Reports whether previous computation was successful. 
ComplexEigenSolver(const MatrixType &matrix, bool computeEigenvectors=true)
Constructor; computes eigendecomposition of given matrix. 
NumTraits< Scalar >::Real RealScalar
EIGEN_STRONG_INLINE const Scalar & coeff(Index rowId, Index colId) const 
EIGEN_STRONG_INLINE Scalar & coeffRef(Index rowId, Index colId)
Index getMaxIterations()
Returns the maximum number of iterations. 
void doComputeEigenvectors(const RealScalar &matrixnorm)
const EigenvectorType & eigenvectors() const 
Returns the eigenvectors of given matrix. 
const ComplexMatrixType & matrixT() const 
Returns the triangular matrix in the Schur decomposition. 
TFSIMD_FORCE_INLINE const tfScalar & z() const 
_MatrixType MatrixType
Synonym for the template parameter _MatrixType. 
ComplexEigenSolver()
Default constructor. 
Index getMaxIterations()
Returns the maximum number of iterations. 
ComplexEigenSolver & setMaxIterations(Index maxIters)
Sets the maximum number of iterations allowed. 
ComputationInfo info() const 
Reports whether previous computation was successful. 
void sortEigenvalues(bool computeEigenvectors)
std::complex< RealScalar > ComplexScalar
Complex scalar type for MatrixType. 
internal::add_const_on_value_type< EIGEN_MATHFUNC_RETVAL(real_ref, Scalar) >::type real_ref(const Scalar &x)
const EigenvalueType & eigenvalues() const 
Returns the eigenvalues of given matrix. 
Computes eigenvalues and eigenvectors of general complex matrices. 
ComplexEigenSolver & compute(const MatrixType &matrix, bool computeEigenvectors=true)
Computes eigendecomposition of given matrix. 
const ComplexMatrixType & matrixU() const 
Returns the unitary matrix in the Schur decomposition.