Public Types | Public Member Functions | Protected Attributes | List of all members
Eigen::PolynomialSolver< _Scalar, _Deg > Class Template Reference

A polynomial solver. More...

#include <PolynomialSolver.h>

Inheritance diagram for Eigen::PolynomialSolver< _Scalar, _Deg >:
Inheritance graph
[legend]

Public Types

typedef Matrix< Scalar, _Deg, _Deg > CompanionMatrixType
 
typedef EigenSolver< CompanionMatrixTypeEigenSolverType
 
typedef PolynomialSolverBase< _Scalar, _Deg > PS_Base
 
- Public Types inherited from Eigen::PolynomialSolverBase< _Scalar, _Deg >
typedef DenseIndex Index
 
typedef NumTraits< Scalar >::Real RealScalar
 
typedef Matrix< RootType, _Deg, 1 > RootsType
 
typedef std::complex< RealScalarRootType
 
typedef _Scalar Scalar
 

Public Member Functions

template<typename OtherPolynomial >
void compute (const OtherPolynomial &poly)
 
template<typename OtherPolynomial >
 PolynomialSolver (const OtherPolynomial &poly)
 
 PolynomialSolver ()
 
- Public Member Functions inherited from Eigen::PolynomialSolverBase< _Scalar, _Deg >
const RealScalarabsGreatestRealRoot (bool &hasArealRoot, const RealScalar &absImaginaryThreshold=NumTraits< Scalar >::dummy_precision()) const
 
const RealScalarabsSmallestRealRoot (bool &hasArealRoot, const RealScalar &absImaginaryThreshold=NumTraits< Scalar >::dummy_precision()) const
 
const RealScalargreatestRealRoot (bool &hasArealRoot, const RealScalar &absImaginaryThreshold=NumTraits< Scalar >::dummy_precision()) const
 
const RootTypegreatestRoot () const
 
template<typename OtherPolynomial >
 PolynomialSolverBase (const OtherPolynomial &poly)
 
 PolynomialSolverBase ()
 
template<typename Stl_back_insertion_sequence >
void realRoots (Stl_back_insertion_sequence &bi_seq, const RealScalar &absImaginaryThreshold=NumTraits< Scalar >::dummy_precision()) const
 
const RootsTyperoots () const
 
const RealScalarsmallestRealRoot (bool &hasArealRoot, const RealScalar &absImaginaryThreshold=NumTraits< Scalar >::dummy_precision()) const
 
const RootTypesmallestRoot () const
 

Protected Attributes

EigenSolverType m_eigenSolver
 
- Protected Attributes inherited from Eigen::PolynomialSolverBase< _Scalar, _Deg >
RootsType m_roots
 

Additional Inherited Members

- Protected Member Functions inherited from Eigen::PolynomialSolverBase< _Scalar, _Deg >
template<typename squaredNormBinaryPredicate >
const RootTypeselectComplexRoot_withRespectToNorm (squaredNormBinaryPredicate &pred) const
 
template<typename squaredRealPartBinaryPredicate >
const RealScalarselectRealRoot_withRespectToAbsRealPart (squaredRealPartBinaryPredicate &pred, bool &hasArealRoot, const RealScalar &absImaginaryThreshold=NumTraits< Scalar >::dummy_precision()) const
 
template<typename RealPartBinaryPredicate >
const RealScalarselectRealRoot_withRespectToRealPart (RealPartBinaryPredicate &pred, bool &hasArealRoot, const RealScalar &absImaginaryThreshold=NumTraits< Scalar >::dummy_precision()) const
 
template<typename OtherPolynomial >
void setPolynomial (const OtherPolynomial &poly)
 

Detailed Description

template<typename _Scalar, int _Deg>
class Eigen::PolynomialSolver< _Scalar, _Deg >

A polynomial solver.

Computes the complex roots of a real polynomial.

Parameters
_Scalarthe scalar type, i.e., the type of the polynomial coefficients
_Degthe degree of the polynomial, can be a compile time value or Dynamic. Notice that the number of polynomial coefficients is _Deg+1.

This class implements a polynomial solver and provides convenient methods such as

WARNING: this polynomial solver is experimental, part of the unsupported Eigen modules.

Currently a QR algorithm is used to compute the eigenvalues of the companion matrix of the polynomial to compute its roots. This supposes that the complex moduli of the roots are all distinct: e.g. there should be no multiple roots or conjugate roots for instance. With 32bit (float) floating types this problem shows up frequently. However, almost always, correct accuracy is reached even in these cases for 64bit (double) floating types and small polynomial degree (<20).

Definition at line 331 of file PolynomialSolver.h.

Member Typedef Documentation

template<typename _Scalar, int _Deg>
typedef Matrix<Scalar,_Deg,_Deg> Eigen::PolynomialSolver< _Scalar, _Deg >::CompanionMatrixType

Definition at line 339 of file PolynomialSolver.h.

template<typename _Scalar, int _Deg>
typedef EigenSolver<CompanionMatrixType> Eigen::PolynomialSolver< _Scalar, _Deg >::EigenSolverType

Definition at line 340 of file PolynomialSolver.h.

template<typename _Scalar, int _Deg>
typedef PolynomialSolverBase<_Scalar,_Deg> Eigen::PolynomialSolver< _Scalar, _Deg >::PS_Base

Definition at line 336 of file PolynomialSolver.h.

Constructor & Destructor Documentation

template<typename _Scalar, int _Deg>
template<typename OtherPolynomial >
Eigen::PolynomialSolver< _Scalar, _Deg >::PolynomialSolver ( const OtherPolynomial &  poly)
inline

Definition at line 365 of file PolynomialSolver.h.

template<typename _Scalar, int _Deg>
Eigen::PolynomialSolver< _Scalar, _Deg >::PolynomialSolver ( )
inline

Definition at line 368 of file PolynomialSolver.h.

Member Function Documentation

template<typename _Scalar, int _Deg>
template<typename OtherPolynomial >
void Eigen::PolynomialSolver< _Scalar, _Deg >::compute ( const OtherPolynomial &  poly)
inline

Computes the complex roots of a new polynomial.

Definition at line 345 of file PolynomialSolver.h.

Member Data Documentation

template<typename _Scalar, int _Deg>
EigenSolverType Eigen::PolynomialSolver< _Scalar, _Deg >::m_eigenSolver
protected

Definition at line 372 of file PolynomialSolver.h.


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


hebiros
Author(s): Xavier Artache , Matthew Tesch
autogenerated on Thu Sep 3 2020 04:10:19