This is the complete list of members for IntegratorRK23, including all inherited members.
| A | IntegratorRK | 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_index | Integrator | protected |
| AlgorithmicBase() | AlgorithmicBase | |
| AlgorithmicBase(UserInteraction *_userInteraction) | AlgorithmicBase | |
| AlgorithmicBase(const AlgorithmicBase &rhs) | AlgorithmicBase | |
| allocateMemory() | IntegratorRK | protected |
| b4 | IntegratorRK | protected |
| b5 | IntegratorRK | protected |
| bseed | IntegratorRK | protected |
| bseed2 | IntegratorRK | protected |
| c | IntegratorRK | protected |
| canHandleImplicitSwitches() const | Integrator | virtual |
| clone() const | IntegratorRK23 | virtual |
| constructAll(const IntegratorRK &arg) | IntegratorRK | protected |
| control_index | Integrator | protected |
| count | Integrator | protected |
| count2 | Integrator | protected |
| count3 | Integrator | protected |
| ddiff_index | Integrator | protected |
| ddxStore | Integrator | protected |
| deleteAll() | IntegratorRK | protected |
| deleteAllSeeds() | Integrator | virtual |
| determineEta45() | IntegratorRK | protected |
| determineEta45(int number) | IntegratorRK | protected |
| determineEtaGForward(int number) | IntegratorRK | protected |
| determineEtaGForward2(int number) | IntegratorRK | protected |
| determineEtaHBackward(int number) | IntegratorRK | protected |
| determineEtaHBackward2(int number) | IntegratorRK | protected |
| diff_index | Integrator | protected |
| diff_scale | Integrator | protected |
| diffTransitionBackward(DVector &DX, DVector &DP, DVector &DU, DVector &DW, int &order) | Integrator | protectedvirtual |
| diffTransitionForward(DVector &DX, const DVector &DP, const DVector &DU, const DVector &DW, const int &order) | Integrator | protectedvirtual |
| dim | IntegratorRK | protected |
| disturbance_index | Integrator | protected |
| dP | Integrator | protected |
| dPb | Integrator | protected |
| dU | Integrator | protected |
| dUb | Integrator | protected |
| dW | Integrator | protected |
| dWb | Integrator | protected |
| dX | Integrator | protected |
| dXb | Integrator | protected |
| dxStore | Integrator | protected |
| err_power | IntegratorRK | protected |
| eta4 | IntegratorRK | protected |
| eta4_ | IntegratorRK | protected |
| eta5 | IntegratorRK | protected |
| eta5_ | IntegratorRK | protected |
| etaG | IntegratorRK | protected |
| etaG2 | IntegratorRK | protected |
| etaG3 | IntegratorRK | protected |
| etaH | IntegratorRK | protected |
| etaH2 | IntegratorRK | protected |
| etaH3 | IntegratorRK | protected |
| evaluate(const DVector &x0, const DVector &xa, const DVector &p, const DVector &u, const DVector &w, const Grid &t_) | IntegratorRK | protectedvirtual |
| evaluateSensitivities() | IntegratorRK | protectedvirtual |
| evaluateTransition(const double time, DVector &xd, const DVector &xa, const DVector &p, const DVector &u, const DVector &w) | Integrator | protectedvirtual |
| freezeAll() | IntegratorRK | virtual |
| freezeMesh() | IntegratorRK | virtual |
| fseed | IntegratorRK | protected |
| fseed2 | IntegratorRK | protected |
| functionEvaluation | Integrator | protected |
| G | IntegratorRK | protected |
| G2 | IntegratorRK | protected |
| G3 | IntegratorRK | 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 | IntegratorRK | protectedvirtual |
| getDimX() const | Integrator | protectedvirtual |
| 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 | IntegratorRK | virtual |
| getNumberOfSteps() const | IntegratorRK | virtual |
| getOptions(uint idx) const | AlgorithmicBase | |
| getProtectedBackwardSensitivities(DVector &Dx_x0, DVector &Dx_p, DVector &Dx_u, DVector &Dx_w, int order) const | IntegratorRK | protectedvirtual |
| getProtectedForwardSensitivities(DMatrix *Dx, int order) const | IntegratorRK | protectedvirtual |
| getProtectedX(DVector *xEnd) const | IntegratorRK | protectedvirtual |
| getStepSize() const | IntegratorRK | 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 |
| H | IntegratorRK | protected |
| h | Integrator | protected |
| H2 | IntegratorRK | protected |
| H3 | IntegratorRK | protected |
| haveOptionsChanged() const | AlgorithmicBase | inline |
| haveOptionsChanged(uint idx) const | AlgorithmicBase | inline |
| hini | Integrator | protected |
| hmax | Integrator | protected |
| hmin | Integrator | protected |
| init(const DifferentialEquation &rhs_) | IntegratorRK | virtual |
| init(const DifferentialEquation &rhs_, const Transition &trs_) | IntegratorRK | inline |
| initializeButcherTableau() | IntegratorRK23 | protectedvirtual |
| initializeOptions() | Integrator | protected |
| initializeVariables() | IntegratorRK | protected |
| int_control_index | Integrator | protected |
| int_parameter_index | Integrator | 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 | |
| IntegratorRK() | IntegratorRK | |
| IntegratorRK(int dim_, double power_) | IntegratorRK | |
| IntegratorRK(const DifferentialEquation &rhs_, int dim_, double power_) | IntegratorRK | |
| IntegratorRK(const IntegratorRK &arg) | IntegratorRK | |
| IntegratorRK23() | IntegratorRK23 | |
| IntegratorRK23(const DifferentialEquation &rhs_) | IntegratorRK23 | |
| IntegratorRK23(const IntegratorRK23 &arg) | IntegratorRK23 | |
| interpolate(int jj, double *e1, double *d1, double *e2, VariablesGrid &poly) | IntegratorRK | protected |
| isDifferentialEquationAffine() const | Integrator | virtual |
| isDifferentialEquationDefined() const | Integrator | virtual |
| iStore | Integrator | protected |
| k | IntegratorRK | protected |
| k2 | IntegratorRK | protected |
| l | IntegratorRK | protected |
| l2 | IntegratorRK | protected |
| las | Integrator | protected |
| logCurrentIntegratorStep(const DVector ¤tX=emptyConstVector) | IntegratorRK | protected |
| m | Integrator | protected |
| ma | Integrator | protected |
| maxAlloc | IntegratorRK | protected |
| maxNumberOfSteps | Integrator | protected |
| md | Integrator | protected |
| mdx | Integrator | protected |
| mn | Integrator | protected |
| mp | Integrator | protected |
| mpi | Integrator | protected |
| mu | Integrator | protected |
| mui | Integrator | protected |
| mw | Integrator | protected |
| nBDirs | Integrator | protected |
| nBDirs2 | Integrator | protected |
| nFcnEvaluations | Integrator | protected |
| nFDirs | Integrator | protected |
| nFDirs2 | Integrator | protected |
| operator=(const IntegratorRK23 &arg) | IntegratorRK23 | virtual |
| IntegratorRK::operator=(const IntegratorRK &arg) | IntegratorRK | virtual |
| Integrator::operator=(const AlgorithmicBase &rhs) | AlgorithmicBase | |
| outputLoggingIdx | AlgorithmicBase | protected |
| parameter_index | Integrator | protected |
| plot(PlotFrequency _frequency=PLOT_IN_ANY_CASE) | AlgorithmicBase | inline |
| printIntermediateResults() | IntegratorRK | protected |
| PrintLevel | Integrator | protected |
| printLogRecord(std::ostream &_stream, int idx, LogPrintMode _mode=PRINT_ITEM_BY_ITEM) const | AlgorithmicBase | inline |
| printRunTimeProfile() const | Integrator | virtual |
| replot(PlotFrequency _frequency=PLOT_IN_ANY_CASE) | AlgorithmicBase | inline |
| rhs | Integrator | 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) | IntegratorRK | protectedvirtual |
| setDxInitialization(double *dx0) | IntegratorRK | 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) | IntegratorRK | 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) | IntegratorRK | protectedvirtual |
| setProtectedForwardSeed(const DVector &xSeed, const DVector &pSeed, const DVector &uSeed, const DVector &wSeed, const int &order) | IntegratorRK | protectedvirtual |
| setTransition(const Transition &trs) | Integrator | |
| setupLogging() | Integrator | protectedvirtual |
| setupOptions() | Integrator | protectedvirtual |
| soa | Integrator | protected |
| step(int number) | IntegratorRK | virtual |
| stop() | IntegratorRK | virtual |
| t | IntegratorRK | protected |
| time_index | Integrator | protected |
| timeInterval | Integrator | protected |
| TOL | Integrator | protected |
| totalTime | Integrator | protected |
| transition | Integrator | protected |
| tune | Integrator | protected |
| unfreeze() | IntegratorRK | virtual |
| useModuleStandalone | AlgorithmicBase | protected |
| userInteraction | AlgorithmicBase | protected |
| x | IntegratorRK | protected |
| xE | Integrator | protected |
| xStore | Integrator | protected |
| ~AlgorithmicBase() | AlgorithmicBase | virtual |
| ~Integrator() | Integrator | virtual |
| ~IntegratorRK() | IntegratorRK | virtual |
| ~IntegratorRK23() | IntegratorRK23 | virtual |