IntegratorBDF Member List
This is the complete list of members for IntegratorBDF, including all inherited members.
AIntegratorBDF [protected]
addLogRecord(LogRecord &_record)AlgorithmicBase [inline]
addOption(OptionsName name, int value)AlgorithmicBase [inline]
addOption(OptionsName name, double value)AlgorithmicBase [inline]
addOption(uint idx, OptionsName name, int value)AlgorithmicBase [inline]
addOption(uint idx, OptionsName name, double value)AlgorithmicBase [inline]
addOptionsList()AlgorithmicBase
alg_indexIntegrator [protected]
AlgorithmicBase()AlgorithmicBase
AlgorithmicBase(UserInteraction *_userInteraction)AlgorithmicBase
AlgorithmicBase(const AlgorithmicBase &rhs)AlgorithmicBase
allocateMemory()IntegratorBDF [protected]
applyMTranspose(int index, double *seed1, DMatrix &J, double *seed2)IntegratorBDF [protected]
applyNewtonStep(int index, double *etakplus1, const double *etak, const DMatrix &J, const double *FFF)IntegratorBDF [protected]
b4IntegratorBDF [protected]
b5IntegratorBDF [protected]
bseedIntegratorBDF [protected]
bseed2IntegratorBDF [protected]
cIntegratorBDF [protected]
c2IntegratorBDF [protected]
c2GIntegratorBDF [protected]
c2G2IntegratorBDF [protected]
c2G3IntegratorBDF [protected]
c2HIntegratorBDF [protected]
c2H2IntegratorBDF [protected]
c2H3IntegratorBDF [protected]
canHandleImplicitSwitches() const Integrator [virtual]
clone() const IntegratorBDF [virtual]
constructAll(const IntegratorBDF &arg)IntegratorBDF [protected]
control_indexIntegrator [protected]
copyBackward(DVector &Dx_x0, DVector &Dx_p, DVector &Dx_u, DVector &Dx_w, const DMatrix &div) const IntegratorBDF [protected]
correctorTimeIntegratorBDF [protected]
countIntegrator [protected]
count2Integrator [protected]
count3Integrator [protected]
ddiff_indexIntegrator [protected]
ddxStoreIntegrator [protected]
decomposeJacobian(int index, DMatrix &J)IntegratorBDF [protected]
deleteAll()IntegratorBDF [protected]
deleteAllSeeds()Integrator [virtual]
deltaIntegratorBDF [protected]
deltaGIntegratorBDF [protected]
deltaG2IntegratorBDF [protected]
deltaG3IntegratorBDF [protected]
deltaHIntegratorBDF [protected]
deltaH2IntegratorBDF [protected]
deltaH3IntegratorBDF [protected]
determineBDFEtaGForward(int number)IntegratorBDF [protected]
determineBDFEtaGForward2(int number)IntegratorBDF [protected]
determineBDFEtaHBackward(int number)IntegratorBDF [protected]
determineBDFEtaHBackward2(int number)IntegratorBDF [protected]
determineCorrector(int number, BooleanType ini)IntegratorBDF [protected]
determinePredictor(int number, BooleanType ini)IntegratorBDF [protected]
determineRKEtaGForward()IntegratorBDF [protected]
determineRKEtaGForward2()IntegratorBDF [protected]
determineRKEtaHBackward()IntegratorBDF [protected]
determineRKEtaHBackward2()IntegratorBDF [protected]
diff_indexIntegrator [protected]
diff_scaleIntegrator [protected]
diffTransitionBackward(DVector &DX, DVector &DP, DVector &DU, DVector &DW, int &order)Integrator [protected, virtual]
diffTransitionForward(DVector &DX, const DVector &DP, const DVector &DU, const DVector &DW, const int &order)Integrator [protected, virtual]
dimIntegratorBDF [protected]
disturbance_indexIntegrator [protected]
dPIntegrator [protected]
dPbIntegrator [protected]
dUIntegrator [protected]
dUbIntegrator [protected]
dWIntegrator [protected]
dWbIntegrator [protected]
dXIntegrator [protected]
dXbIntegrator [protected]
dxStoreIntegrator [protected]
etaIntegratorBDF [protected]
eta2IntegratorBDF [protected]
eta4IntegratorBDF [protected]
eta4_IntegratorBDF [protected]
eta5IntegratorBDF [protected]
eta5_IntegratorBDF [protected]
etaGIntegratorBDF [protected]
etaG2IntegratorBDF [protected]
etaG3IntegratorBDF [protected]
etaHIntegratorBDF [protected]
etaH2IntegratorBDF [protected]
etaH3IntegratorBDF [protected]
evaluate(const DVector &x0, const DVector &xa, const DVector &p, const DVector &u, const DVector &w, const Grid &t_)IntegratorBDF [protected, virtual]
evaluateSensitivities()IntegratorBDF [protected, virtual]
evaluateTransition(const double time, DVector &xd, const DVector &xa, const DVector &p, const DVector &u, const DVector &w)Integrator [protected, virtual]
FIntegratorBDF [protected]
F2IntegratorBDF [protected]
freezeAll()IntegratorBDF [virtual]
freezeMesh()IntegratorBDF [virtual]
fseedIntegratorBDF [protected]
fseed2IntegratorBDF [protected]
functionEvaluationIntegrator [protected]
GIntegratorBDF [protected]
G2IntegratorBDF [protected]
G3IntegratorBDF [protected]
gammaIntegratorBDF [protected]
get(OptionsName name, int &value) const AlgorithmicBase [inline]
get(OptionsName name, double &value) const AlgorithmicBase [inline]
get(OptionsName name, std::string &value) const AlgorithmicBase [inline]
get(uint idx, OptionsName name, int &value) const AlgorithmicBase [inline]
get(uint idx, OptionsName name, double &value) const AlgorithmicBase [inline]
getAll(LogName _name, MatrixVariablesGrid &values) const AlgorithmicBase [inline]
getBackwardSensitivities(DVector &Dx_x0, DVector &Dx_p, DVector &Dx_u, DVector &Dx_w, int order) const Integrator
getDifferentialEquationSampleTime() const Integrator [virtual]
getDim() const IntegratorBDF [protected, virtual]
getDimX() const IntegratorBDF [protected, virtual]
getFirst(LogName _name, DMatrix &firstValue) const AlgorithmicBase [inline]
getFirst(LogName _name, VariablesGrid &firstValue) const AlgorithmicBase [inline]
getForwardSensitivities(DVector &Dx, int order) const Integrator
getForwardSensitivities(VariablesGrid &Dx, int order) const Integrator
getI(VariablesGrid &I) const Integrator [inline]
getLast(LogName _name, DMatrix &lastValue) const AlgorithmicBase [inline]
getLast(LogName _name, VariablesGrid &lastValue) const AlgorithmicBase [inline]
getNumberOfRejectedSteps() const IntegratorBDF [virtual]
getNumberOfSteps() const IntegratorBDF [virtual]
getOptions(uint idx) const AlgorithmicBase
getProtectedBackwardSensitivities(DVector &Dx_x0, DVector &Dx_p, DVector &Dx_u, DVector &Dx_w, int order) const IntegratorBDF [protected, virtual]
getProtectedForwardSensitivities(DMatrix *Dx, int order) const IntegratorBDF [protected, virtual]
Integrator::getProtectedForwardSensitivities(DMatrix *Dx, int order) const =0Integrator [protected, pure virtual]
getProtectedX(DVector *xEnd) const IntegratorBDF [protected, virtual]
getStepSize() const IntegratorBDF [virtual]
getX(DVector &xEnd) const Integrator [inline]
getX(VariablesGrid &X) const Integrator [inline]
getXA(DVector &xaEnd) const Integrator [inline]
getXA(VariablesGrid &XA) const Integrator [inline]
HIntegratorBDF [protected]
hIntegrator [protected]
H2IntegratorBDF [protected]
H3IntegratorBDF [protected]
haveOptionsChanged() const AlgorithmicBase [inline]
haveOptionsChanged(uint idx) const AlgorithmicBase [inline]
hiniIntegrator [protected]
hmaxIntegrator [protected]
hminIntegrator [protected]
init(const DifferentialEquation &rhs_)IntegratorBDF [virtual]
init(const DifferentialEquation &rhs_, const Transition &trs_)IntegratorBDF [inline]
initial_guessIntegratorBDF [protected]
initialAlgebraicResiduumIntegratorBDF [protected]
initializeButcherTableau()IntegratorBDF [protected]
initializeOptions()Integrator [protected]
initializeVariables()IntegratorBDF [protected]
int_control_indexIntegrator [protected]
int_parameter_indexIntegrator [protected]
integrate(double t0, double tend, double *x0, double *xa=0, double *p=0, double *u=0, double *w=0)Integrator
integrate(const Grid &t, double *x0, double *xa=0, double *p=0, double *u=0, double *w=0)Integrator
integrate(double t0, double tend, const DVector &x0, const DVector &xa=emptyVector, const DVector &p=emptyVector, const DVector &u=emptyVector, const DVector &w=emptyVector)Integrator
integrate(const Grid &t, const DVector &x0, const DVector &xa=emptyVector, const DVector &p=emptyVector, const DVector &u=emptyVector, const DVector &w=emptyVector)Integrator
integrateSensitivities()Integrator
Integrator()Integrator
Integrator(const Integrator &arg)Integrator
IntegratorBDF()IntegratorBDF
IntegratorBDF(const DifferentialEquation &rhs_)IntegratorBDF
IntegratorBDF(const IntegratorBDF &arg)IntegratorBDF
interpolate(int number_, DMatrix &div, VariablesGrid &poly)IntegratorBDF [protected]
isDifferentialEquationAffine() const Integrator [virtual]
isDifferentialEquationDefined() const Integrator [virtual]
iseedIntegratorBDF [protected]
iStoreIntegrator [protected]
jacComputationIntegratorBDF [protected]
jacDecompositionIntegratorBDF [protected]
kIntegratorBDF [protected]
k2IntegratorBDF [protected]
kHIntegratorBDF [protected]
kH2IntegratorBDF [protected]
kH3IntegratorBDF [protected]
lIntegratorBDF [protected]
l2IntegratorBDF [protected]
lasIntegrator [protected]
logCurrentIntegratorStep(const DVector &currentX=emptyConstVector, const DVector &currentXA=emptyConstVector)IntegratorBDF [protected]
mIntegrator [protected]
MIntegratorBDF [protected]
M_indexIntegratorBDF [protected]
maIntegrator [protected]
maxAllocIntegratorBDF [protected]
maxNMIntegratorBDF [protected]
maxNumberOfStepsIntegrator [protected]
mdIntegrator [protected]
mdxIntegrator [protected]
mnIntegrator [protected]
mpIntegrator [protected]
mpiIntegrator [protected]
muIntegrator [protected]
muiIntegrator [protected]
mwIntegrator [protected]
nablaGIntegratorBDF [protected]
nablaG2IntegratorBDF [protected]
nablaG3IntegratorBDF [protected]
nablaHIntegratorBDF [protected]
nablaH2IntegratorBDF [protected]
nablaH2_IntegratorBDF [protected]
nablaH3IntegratorBDF [protected]
nablaH3_IntegratorBDF [protected]
nablaH_IntegratorBDF [protected]
nablaYIntegratorBDF [protected]
nablaY_IntegratorBDF [protected]
nBDirsIntegrator [protected]
nBDirs2Integrator [protected]
ndirIntegratorBDF [protected]
nFcnEvaluationsIntegrator [protected]
nFDirsIntegrator [protected]
nFDirs2Integrator [protected]
nJacEvaluationsIntegratorBDF [protected]
nOfMIntegratorBDF [protected]
nOfNewtonStepsIntegratorBDF [protected]
nstepIntegratorBDF [protected]
operator=(const IntegratorBDF &arg)IntegratorBDF [virtual]
Integrator::operator=(const AlgorithmicBase &rhs)AlgorithmicBase
outputLoggingIdxAlgorithmicBase [protected]
parameter_indexIntegrator [protected]
phiIntegratorBDF [protected]
phiGIntegratorBDF [protected]
phiG2IntegratorBDF [protected]
phiG3IntegratorBDF [protected]
plot(PlotFrequency _frequency=PLOT_IN_ANY_CASE)AlgorithmicBase [inline]
prepareDividedDifferences(DMatrix &div)IntegratorBDF [protected]
printBDFfinalResults()IntegratorBDF [protected]
printBDFfinalResults2(DMatrix &div)IntegratorBDF [protected]
printBDFIntermediateResults()IntegratorBDF [protected]
PrintLevelIntegrator [protected]
printLogRecord(std::ostream &_stream, int idx, LogPrintMode _mode=PRINT_ITEM_BY_ITEM) const AlgorithmicBase [inline]
printRKIntermediateResults()IntegratorBDF [protected]
printRunTimeProfile() const Integrator [virtual]
psiIntegratorBDF [protected]
psi_IntegratorBDF [protected]
rel_time_scaleIntegratorBDF [protected]
relaxAlgebraic(double *residuum, double timePoint)IntegratorBDF [protected]
relaxationConstantIntegratorBDF [protected]
replot(PlotFrequency _frequency=PLOT_IN_ANY_CASE)AlgorithmicBase [inline]
rhsIntegrator [protected]
rk_start()IntegratorBDF [protected]
rk_start_solve(int stepnumber)IntegratorBDF [protected]
set(OptionsName name, int value)AlgorithmicBase
set(OptionsName name, double value)AlgorithmicBase
set(OptionsName name, const std::string &value)AlgorithmicBase
set(uint idx, OptionsName name, int value)AlgorithmicBase
set(uint idx, OptionsName name, double value)AlgorithmicBase
setAll(LogName _name, const MatrixVariablesGrid &values)AlgorithmicBase [inline]
setBackwardSeed(const int &order, const DVector &seed)Integrator
setBackwardSeed2(const DVector &seed)IntegratorBDF [protected, virtual]
setDxInitialization(double *dx0)IntegratorBDF [virtual]
setForwardSeed(const int &order, const DVector &xSeed, const DVector &pSeed=emptyVector, const DVector &uSeed=emptyVector, const DVector &wSeed=emptyVector)Integrator
setForwardSeed2(const DVector &xSeed, const DVector &pSeed, const DVector &uSeed, const DVector &wSeed)IntegratorBDF [protected]
setLast(LogName _name, int lastValue, double time=-INFTY)AlgorithmicBase [inline]
setLast(LogName _name, double lastValue, double time=-INFTY)AlgorithmicBase [inline]
setLast(LogName _name, const DVector &lastValue, double time=-INFTY)AlgorithmicBase [inline]
setLast(LogName _name, const DMatrix &lastValue, double time=-INFTY)AlgorithmicBase [inline]
setLast(LogName _name, const VariablesGrid &lastValue, double time=-INFTY)AlgorithmicBase [inline]
setOptions(const Options &arg)AlgorithmicBase
setOptions(uint idx, const Options &arg)AlgorithmicBase
setProtectedBackwardSeed(const DVector &seed, const int &order)IntegratorBDF [protected, virtual]
setProtectedForwardSeed(const DVector &xSeed, const DVector &pSeed, const DVector &uSeed, const DVector &wSeed, const int &order)IntegratorBDF [protected, virtual]
setTransition(const Transition &trs)Integrator
setupLogging()Integrator [protected, virtual]
setupOptions()Integrator [protected, virtual]
ShootingMethod classIntegratorBDF [friend]
SimulationByIntegration classIntegratorBDF [friend]
soaIntegrator [protected]
step(int number)IntegratorBDF [virtual]
stop()IntegratorBDF [virtual]
tIntegratorBDF [protected]
time_indexIntegrator [protected]
timeIntervalIntegrator [protected]
TOLIntegrator [protected]
totalTimeIntegrator [protected]
transitionIntegrator [protected]
tuneIntegrator [protected]
unfreeze()IntegratorBDF [virtual]
useModuleStandaloneAlgorithmicBase [protected]
userInteractionAlgorithmicBase [protected]
xIntegratorBDF [protected]
xEIntegrator [protected]
xStoreIntegrator [protected]
zHIntegratorBDF [protected]
zH2IntegratorBDF [protected]
zH3IntegratorBDF [protected]
~AlgorithmicBase()AlgorithmicBase [virtual]
~Integrator()Integrator [virtual]
~IntegratorBDF()IntegratorBDF [virtual]


acado
Author(s): Milan Vukov, Rien Quirynen
autogenerated on Thu Aug 27 2015 12:01:39