Classes | Public Types | Public Member Functions | Static Public Member Functions | Public Attributes | Private Member Functions | Static Private Member Functions | Private Attributes | List of all members
Eigen::LevenbergMarquardt< _FunctorType > Class Template Reference

Performs non linear optimization over a non-linear function, using a variant of the Levenberg Marquardt algorithm. More...

#include <LevenbergMarquardt.h>

Inheritance diagram for Eigen::LevenbergMarquardt< _FunctorType >:
Inheritance graph
[legend]

Classes

struct  Parameters
 

Public Types

typedef _FunctorType FunctorType
 
typedef Matrix< Scalar, Dynamic, 1 > FVectorType
 
typedef Matrix< Scalar, Dynamic, 1 > FVectorType
 
typedef DenseIndex Index
 
typedef Matrix< Scalar, Dynamic, DynamicJacobianType
 
typedef FunctorType::JacobianType JacobianType
 
typedef QRSolver::StorageIndex PermIndex
 
typedef PermutationMatrix< Dynamic, DynamicPermutationType
 
typedef FunctorType::QRSolver QRSolver
 
typedef JacobianType::RealScalar RealScalar
 
typedef JacobianType::Scalar Scalar
 

Public Member Functions

FVectorTypediag ()
 
RealScalar epsilon () const
 
RealScalar factor () const
 
RealScalar fnorm ()
 
RealScalar ftol () const
 
FVectorTypefvec ()
 
RealScalar gnorm ()
 
RealScalar gtol () const
 
ComputationInfo info () const
 Reports whether the minimization was successful. More...
 
Index iterations ()
 
JacobianTypejacobian ()
 
 LevenbergMarquardt (FunctorType &_functor)
 
 LevenbergMarquardt (FunctorType &functor)
 
Scalar lm_param (void)
 
RealScalar lm_param (void)
 
LevenbergMarquardtSpace::Status lmder1 (FVectorType &x, const Scalar tol=sqrt_epsilon())
 
LevenbergMarquardtSpace::Status lmder1 (FVectorType &x, const Scalar tol=std::sqrt(NumTraits< Scalar >::epsilon()))
 
LevenbergMarquardtSpace::Status lmstr1 (FVectorType &x, const Scalar tol=sqrt_epsilon())
 
JacobianTypematrixR ()
 
Index maxfev () const
 
LevenbergMarquardtSpace::Status minimize (FVectorType &x)
 
LevenbergMarquardtSpace::Status minimize (FVectorType &x)
 
LevenbergMarquardtSpace::Status minimizeInit (FVectorType &x)
 
LevenbergMarquardtSpace::Status minimizeInit (FVectorType &x)
 
LevenbergMarquardtSpace::Status minimizeOneStep (FVectorType &x)
 
LevenbergMarquardtSpace::Status minimizeOneStep (FVectorType &x)
 
LevenbergMarquardtSpace::Status minimizeOptimumStorage (FVectorType &x)
 
LevenbergMarquardtSpace::Status minimizeOptimumStorageInit (FVectorType &x)
 
LevenbergMarquardtSpace::Status minimizeOptimumStorageOneStep (FVectorType &x)
 
Index nfev ()
 
Index njev ()
 
PermutationType permutation ()
 
void resetParameters (void)
 
void resetParameters ()
 
void setEpsilon (RealScalar epsfcn)
 
void setExternalScaling (bool value)
 
void setFactor (RealScalar factor)
 
void setFtol (RealScalar ftol)
 
void setGtol (RealScalar gtol)
 
void setMaxfev (Index maxfev)
 
void setXtol (RealScalar xtol)
 
RealScalar xtol () const
 

Static Public Member Functions

static LevenbergMarquardtSpace::Status lmdif1 (FunctorType &functor, FVectorType &x, Index *nfev, const Scalar tol=sqrt_epsilon())
 
static LevenbergMarquardtSpace::Status lmdif1 (FunctorType &functor, FVectorType &x, Index *nfev, const Scalar tol=std::sqrt(NumTraits< Scalar >::epsilon()))
 

Public Attributes

FVectorType diag
 
JacobianType fjac
 
Scalar fnorm
 
FVectorType fvec
 
Scalar gnorm
 
Index iter
 
Index nfev
 
Index njev
 
Parameters parameters
 
PermutationMatrix< Dynamic, Dynamicpermutation
 
FVectorType qtf
 
bool useExternalScaling
 

Private Member Functions

LevenbergMarquardtoperator= (const LevenbergMarquardt &)
 

Static Private Member Functions

static Scalar sqrt_epsilon ()
 

Private Attributes

Scalar actred
 
Scalar delta
 
Scalar dirder
 
Scalar fnorm1
 
FunctorTypefunctor
 
Index m
 
RealScalar m_delta
 
FVectorType m_diag
 
RealScalar m_epsfcn
 
RealScalar m_factor
 
JacobianType m_fjac
 
RealScalar m_fnorm
 
RealScalar m_ftol
 
FunctorTypem_functor
 
FVectorType m_fvec
 
RealScalar m_gnorm
 
RealScalar m_gtol
 
ComputationInfo m_info
 
bool m_isInitialized
 
Index m_iter
 
Index m_maxfev
 
Index m_nfev
 
Index m_njev
 
RealScalar m_par
 
PermutationType m_permutation
 
FVectorType m_qtf
 
JacobianType m_rfactor
 
bool m_useExternalScaling
 
FVectorType m_wa1
 
FVectorType m_wa2
 
FVectorType m_wa3
 
FVectorType m_wa4
 
RealScalar m_xtol
 
Index n
 
Scalar par
 
Scalar pnorm
 
Scalar prered
 
Scalar ratio
 
Scalar sum
 
Scalar temp
 
Scalar temp1
 
Scalar temp2
 
FVectorType wa1
 
FVectorType wa2
 
FVectorType wa3
 
FVectorType wa4
 
Scalar xnorm
 

Detailed Description

template<typename _FunctorType>
class Eigen::LevenbergMarquardt< _FunctorType >

Performs non linear optimization over a non-linear function, using a variant of the Levenberg Marquardt algorithm.

Check wikipedia for more information. http://en.wikipedia.org/wiki/Levenberg%E2%80%93Marquardt_algorithm

Definition at line 110 of file LevenbergMarquardt/LevenbergMarquardt.h.

Member Typedef Documentation

template<typename _FunctorType>
typedef _FunctorType Eigen::LevenbergMarquardt< _FunctorType >::FunctorType

Definition at line 113 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
typedef Matrix< Scalar, Dynamic, 1 > Eigen::LevenbergMarquardt< _FunctorType >::FVectorType

Definition at line 76 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
typedef Matrix<Scalar,Dynamic,1> Eigen::LevenbergMarquardt< _FunctorType >::FVectorType

Definition at line 119 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
typedef DenseIndex Eigen::LevenbergMarquardt< _FunctorType >::Index

Definition at line 58 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
typedef Matrix< Scalar, Dynamic, Dynamic > Eigen::LevenbergMarquardt< _FunctorType >::JacobianType

Definition at line 77 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
typedef FunctorType::JacobianType Eigen::LevenbergMarquardt< _FunctorType >::JacobianType

Definition at line 115 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
typedef QRSolver::StorageIndex Eigen::LevenbergMarquardt< _FunctorType >::PermIndex

Definition at line 118 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
typedef PermutationMatrix<Dynamic,Dynamic> Eigen::LevenbergMarquardt< _FunctorType >::PermutationType

Definition at line 120 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
typedef FunctorType::QRSolver Eigen::LevenbergMarquardt< _FunctorType >::QRSolver

Definition at line 114 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
typedef JacobianType::RealScalar Eigen::LevenbergMarquardt< _FunctorType >::RealScalar

Definition at line 117 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
typedef JacobianType::Scalar Eigen::LevenbergMarquardt< _FunctorType >::Scalar

Definition at line 116 of file LevenbergMarquardt/LevenbergMarquardt.h.

Constructor & Destructor Documentation

template<typename _FunctorType>
Eigen::LevenbergMarquardt< _FunctorType >::LevenbergMarquardt ( FunctorType functor)
inline

Definition at line 122 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
Eigen::LevenbergMarquardt< _FunctorType >::LevenbergMarquardt ( FunctorType _functor)
inline

Definition at line 55 of file NonLinearOptimization/LevenbergMarquardt.h.

Member Function Documentation

template<typename _FunctorType>
FVectorType& Eigen::LevenbergMarquardt< _FunctorType >::diag ( )
inline
Returns
a reference to the diagonal of the jacobian

Definition at line 197 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
RealScalar Eigen::LevenbergMarquardt< _FunctorType >::epsilon ( ) const
inline
Returns
the error precision

Definition at line 191 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
RealScalar Eigen::LevenbergMarquardt< _FunctorType >::factor ( ) const
inline
Returns
the step bound for the diagonal shift

Definition at line 188 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
RealScalar Eigen::LevenbergMarquardt< _FunctorType >::fnorm ( )
inline
Returns
the norm of current vector function

Definition at line 209 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
RealScalar Eigen::LevenbergMarquardt< _FunctorType >::ftol ( ) const
inline
Returns
the tolerance for the norm of the vector function

Definition at line 182 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
FVectorType& Eigen::LevenbergMarquardt< _FunctorType >::fvec ( )
inline
Returns
a reference to the current vector function

Definition at line 219 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
RealScalar Eigen::LevenbergMarquardt< _FunctorType >::gnorm ( )
inline
Returns
the norm of the gradient of the error

Definition at line 212 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
RealScalar Eigen::LevenbergMarquardt< _FunctorType >::gtol ( ) const
inline
Returns
the tolerance for the norm of the gradient of the error vector

Definition at line 185 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
ComputationInfo Eigen::LevenbergMarquardt< _FunctorType >::info ( ) const
inline

Reports whether the minimization was successful.

Returns
Success if the minimization was succesful, NumericalIssue if a numerical problem arises during the minimization process, for exemple during the QR factorization NoConvergence if the minimization did not converge after the maximum number of function evaluation allowed InvalidInput if the input matrix is invalid

Definition at line 243 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
Index Eigen::LevenbergMarquardt< _FunctorType >::iterations ( )
inline
Returns
the number of iterations performed

Definition at line 200 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
JacobianType& Eigen::LevenbergMarquardt< _FunctorType >::jacobian ( )
inline
Returns
a reference to the matrix where the current Jacobian matrix is stored

Definition at line 223 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
Scalar Eigen::LevenbergMarquardt< _FunctorType >::lm_param ( void  )
inline

Definition at line 116 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
RealScalar Eigen::LevenbergMarquardt< _FunctorType >::lm_param ( void  )
inline
Returns
the LevenbergMarquardt parameter

Definition at line 215 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
LevenbergMarquardtSpace::Status Eigen::LevenbergMarquardt< _FunctorType >::lmder1 ( FVectorType x,
const Scalar  tol = sqrt_epsilon() 
)
template<typename FunctorType , typename Scalar >
LevenbergMarquardtSpace::Status Eigen::LevenbergMarquardt< FunctorType, Scalar >::lmder1 ( FVectorType x,
const Scalar  tol = std::sqrt(NumTraits<Scalar>::epsilon()) 
)

Definition at line 344 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
static LevenbergMarquardtSpace::Status Eigen::LevenbergMarquardt< _FunctorType >::lmdif1 ( FunctorType functor,
FVectorType x,
Index nfev,
const Scalar  tol = sqrt_epsilon() 
)
static
template<typename FunctorType , typename Scalar >
LevenbergMarquardtSpace::Status Eigen::LevenbergMarquardt< FunctorType, Scalar >::lmdif1 ( FunctorType functor,
FVectorType x,
Index nfev,
const Scalar  tol = std::sqrt(NumTraits<Scalar>::epsilon()) 
)
static

Definition at line 367 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename FunctorType , typename Scalar >
LevenbergMarquardtSpace::Status Eigen::LevenbergMarquardt< FunctorType, Scalar >::lmstr1 ( FVectorType x,
const Scalar  tol = sqrt_epsilon() 
)

Definition at line 363 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
JacobianType& Eigen::LevenbergMarquardt< _FunctorType >::matrixR ( )
inline
Returns
a reference to the triangular matrix R from the QR of the jacobian matrix.
See also
jacobian()

Definition at line 228 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
Index Eigen::LevenbergMarquardt< _FunctorType >::maxfev ( ) const
inline
Returns
the maximum number of function evaluation

Definition at line 194 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
LevenbergMarquardtSpace::Status Eigen::LevenbergMarquardt< _FunctorType >::minimize ( FVectorType x)
template<typename FunctorType , typename Scalar >
LevenbergMarquardtSpace::Status Eigen::LevenbergMarquardt< FunctorType, Scalar >::minimize ( FVectorType x)

Definition at line 277 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
LevenbergMarquardtSpace::Status Eigen::LevenbergMarquardt< _FunctorType >::minimizeInit ( FVectorType x)
template<typename FunctorType , typename Scalar >
LevenbergMarquardtSpace::Status Eigen::LevenbergMarquardt< FunctorType, Scalar >::minimizeInit ( FVectorType x)

Definition at line 294 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
LevenbergMarquardtSpace::Status Eigen::LevenbergMarquardt< _FunctorType >::minimizeOneStep ( FVectorType x)
template<typename FunctorType , typename Scalar >
LevenbergMarquardtSpace::Status Eigen::LevenbergMarquardt< FunctorType, Scalar >::minimizeOneStep ( FVectorType x)

Definition at line 21 of file LMonestep.h.

template<typename FunctorType , typename Scalar >
LevenbergMarquardtSpace::Status Eigen::LevenbergMarquardt< FunctorType, Scalar >::minimizeOptimumStorage ( FVectorType x)

Definition at line 613 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename FunctorType , typename Scalar >
LevenbergMarquardtSpace::Status Eigen::LevenbergMarquardt< FunctorType, Scalar >::minimizeOptimumStorageInit ( FVectorType x)

Definition at line 385 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename FunctorType , typename Scalar >
LevenbergMarquardtSpace::Status Eigen::LevenbergMarquardt< FunctorType, Scalar >::minimizeOptimumStorageOneStep ( FVectorType x)

Definition at line 434 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
Index Eigen::LevenbergMarquardt< _FunctorType >::nfev ( )
inline
Returns
the number of functions evaluation

Definition at line 203 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
Index Eigen::LevenbergMarquardt< _FunctorType >::njev ( )
inline
Returns
the number of jacobian evaluation

Definition at line 206 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
LevenbergMarquardt& Eigen::LevenbergMarquardt< _FunctorType >::operator= ( const LevenbergMarquardt< _FunctorType > &  )
private
template<typename _FunctorType>
PermutationType Eigen::LevenbergMarquardt< _FunctorType >::permutation ( )
inline

the permutation used in the QR factorization

Definition at line 232 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
void Eigen::LevenbergMarquardt< _FunctorType >::resetParameters ( void  )
inline

Definition at line 104 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
void Eigen::LevenbergMarquardt< _FunctorType >::resetParameters ( )
inline

Sets the default parameters

Definition at line 145 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
void Eigen::LevenbergMarquardt< _FunctorType >::setEpsilon ( RealScalar  epsfcn)
inline

Sets the error precision

Definition at line 170 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
void Eigen::LevenbergMarquardt< _FunctorType >::setExternalScaling ( bool  value)
inline

Use an external Scaling. If set to true, pass a nonzero diagonal to diag()

Definition at line 176 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
void Eigen::LevenbergMarquardt< _FunctorType >::setFactor ( RealScalar  factor)
inline

Sets the step bound for the diagonal shift

Definition at line 167 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
void Eigen::LevenbergMarquardt< _FunctorType >::setFtol ( RealScalar  ftol)
inline

Sets the tolerance for the norm of the vector function

Definition at line 161 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
void Eigen::LevenbergMarquardt< _FunctorType >::setGtol ( RealScalar  gtol)
inline

Sets the tolerance for the norm of the gradient of the error vector

Definition at line 164 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
void Eigen::LevenbergMarquardt< _FunctorType >::setMaxfev ( Index  maxfev)
inline

Sets the maximum number of function evaluation

Definition at line 173 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
void Eigen::LevenbergMarquardt< _FunctorType >::setXtol ( RealScalar  xtol)
inline

Sets the tolerance for the norm of the solution vector

Definition at line 158 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
static Scalar Eigen::LevenbergMarquardt< _FunctorType >::sqrt_epsilon ( )
inlinestaticprivate

Definition at line 48 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
RealScalar Eigen::LevenbergMarquardt< _FunctorType >::xtol ( ) const
inline
Returns
the tolerance for the norm of the solution vector

Definition at line 179 of file LevenbergMarquardt/LevenbergMarquardt.h.

Member Data Documentation

template<typename _FunctorType>
Scalar Eigen::LevenbergMarquardt< _FunctorType >::actred
private

Definition at line 128 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
Scalar Eigen::LevenbergMarquardt< _FunctorType >::delta
private

Definition at line 126 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
FVectorType Eigen::LevenbergMarquardt< _FunctorType >::diag

Definition at line 107 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
Scalar Eigen::LevenbergMarquardt< _FunctorType >::dirder
private

Definition at line 128 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
JacobianType Eigen::LevenbergMarquardt< _FunctorType >::fjac

Definition at line 108 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
Scalar Eigen::LevenbergMarquardt< _FunctorType >::fnorm

Definition at line 113 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
Scalar Eigen::LevenbergMarquardt< _FunctorType >::fnorm1
private

Definition at line 128 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
FunctorType& Eigen::LevenbergMarquardt< _FunctorType >::functor
private

Definition at line 119 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
FVectorType Eigen::LevenbergMarquardt< _FunctorType >::fvec

Definition at line 107 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
Scalar Eigen::LevenbergMarquardt< _FunctorType >::gnorm

Definition at line 113 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
Index Eigen::LevenbergMarquardt< _FunctorType >::iter

Definition at line 112 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
Index Eigen::LevenbergMarquardt< _FunctorType >::m
private

Definition at line 254 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
RealScalar Eigen::LevenbergMarquardt< _FunctorType >::m_delta
private

Definition at line 266 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
FVectorType Eigen::LevenbergMarquardt< _FunctorType >::m_diag
private

Definition at line 252 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
RealScalar Eigen::LevenbergMarquardt< _FunctorType >::m_epsfcn
private

Definition at line 264 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
RealScalar Eigen::LevenbergMarquardt< _FunctorType >::m_factor
private

Definition at line 259 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
JacobianType Eigen::LevenbergMarquardt< _FunctorType >::m_fjac
private

Definition at line 249 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
RealScalar Eigen::LevenbergMarquardt< _FunctorType >::m_fnorm
private

Definition at line 257 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
RealScalar Eigen::LevenbergMarquardt< _FunctorType >::m_ftol
private

Definition at line 261 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
FunctorType& Eigen::LevenbergMarquardt< _FunctorType >::m_functor
private

Definition at line 251 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
FVectorType Eigen::LevenbergMarquardt< _FunctorType >::m_fvec
private

Definition at line 252 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
RealScalar Eigen::LevenbergMarquardt< _FunctorType >::m_gnorm
private

Definition at line 258 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
RealScalar Eigen::LevenbergMarquardt< _FunctorType >::m_gtol
private

Definition at line 263 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
ComputationInfo Eigen::LevenbergMarquardt< _FunctorType >::m_info
private

Definition at line 272 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
bool Eigen::LevenbergMarquardt< _FunctorType >::m_isInitialized
private

Definition at line 271 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
Index Eigen::LevenbergMarquardt< _FunctorType >::m_iter
private

Definition at line 265 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
Index Eigen::LevenbergMarquardt< _FunctorType >::m_maxfev
private

Definition at line 260 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
Index Eigen::LevenbergMarquardt< _FunctorType >::m_nfev
private

Definition at line 255 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
Index Eigen::LevenbergMarquardt< _FunctorType >::m_njev
private

Definition at line 256 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
RealScalar Eigen::LevenbergMarquardt< _FunctorType >::m_par
private

Definition at line 270 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
PermutationType Eigen::LevenbergMarquardt< _FunctorType >::m_permutation
private

Definition at line 268 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
FVectorType Eigen::LevenbergMarquardt< _FunctorType >::m_qtf
private

Definition at line 252 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
JacobianType Eigen::LevenbergMarquardt< _FunctorType >::m_rfactor
private

Definition at line 250 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
bool Eigen::LevenbergMarquardt< _FunctorType >::m_useExternalScaling
private

Definition at line 267 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
FVectorType Eigen::LevenbergMarquardt< _FunctorType >::m_wa1
private

Definition at line 269 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
FVectorType Eigen::LevenbergMarquardt< _FunctorType >::m_wa2
private

Definition at line 269 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
FVectorType Eigen::LevenbergMarquardt< _FunctorType >::m_wa3
private

Definition at line 269 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
FVectorType Eigen::LevenbergMarquardt< _FunctorType >::m_wa4
private

Definition at line 269 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
RealScalar Eigen::LevenbergMarquardt< _FunctorType >::m_xtol
private

Definition at line 262 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
Index Eigen::LevenbergMarquardt< _FunctorType >::n
private

Definition at line 253 of file LevenbergMarquardt/LevenbergMarquardt.h.

template<typename _FunctorType>
Index Eigen::LevenbergMarquardt< _FunctorType >::nfev

Definition at line 110 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
Index Eigen::LevenbergMarquardt< _FunctorType >::njev

Definition at line 111 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
Scalar Eigen::LevenbergMarquardt< _FunctorType >::par
private

Definition at line 124 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
Parameters Eigen::LevenbergMarquardt< _FunctorType >::parameters

Definition at line 106 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
PermutationMatrix<Dynamic,Dynamic> Eigen::LevenbergMarquardt< _FunctorType >::permutation

Definition at line 109 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
Scalar Eigen::LevenbergMarquardt< _FunctorType >::pnorm
private

Definition at line 128 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
Scalar Eigen::LevenbergMarquardt< _FunctorType >::prered
private

Definition at line 128 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
FVectorType Eigen::LevenbergMarquardt< _FunctorType >::qtf

Definition at line 107 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
Scalar Eigen::LevenbergMarquardt< _FunctorType >::ratio
private

Definition at line 127 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
Scalar Eigen::LevenbergMarquardt< _FunctorType >::sum
private

Definition at line 124 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
Scalar Eigen::LevenbergMarquardt< _FunctorType >::temp
private

Definition at line 125 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
Scalar Eigen::LevenbergMarquardt< _FunctorType >::temp1
private

Definition at line 125 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
Scalar Eigen::LevenbergMarquardt< _FunctorType >::temp2
private

Definition at line 125 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
bool Eigen::LevenbergMarquardt< _FunctorType >::useExternalScaling

Definition at line 114 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
FVectorType Eigen::LevenbergMarquardt< _FunctorType >::wa1
private

Definition at line 122 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
FVectorType Eigen::LevenbergMarquardt< _FunctorType >::wa2
private

Definition at line 122 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
FVectorType Eigen::LevenbergMarquardt< _FunctorType >::wa3
private

Definition at line 122 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
FVectorType Eigen::LevenbergMarquardt< _FunctorType >::wa4
private

Definition at line 122 of file NonLinearOptimization/LevenbergMarquardt.h.

template<typename _FunctorType>
Scalar Eigen::LevenbergMarquardt< _FunctorType >::xnorm
private

Definition at line 128 of file NonLinearOptimization/LevenbergMarquardt.h.


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


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