| Package | Description |
|---|---|
| org.orekit.attitudes |
This package provides classes to represent simple attitudes.
|
| org.orekit.estimation.measurements |
The measurements package defines everything that is related to orbit
determination measurements.
|
| org.orekit.estimation.measurements.filtering |
This package provides measurement pre-processing filters.
|
| org.orekit.estimation.measurements.gnss |
This package provides methods to handle GNSS measurements.
|
| org.orekit.estimation.measurements.modifiers |
This package provides measurement modifier.
|
| org.orekit.estimation.sequential |
The sequential package provides an implementation of a
Kalman Filter engine to perform an orbit determination.
|
| org.orekit.files.ccsds.ndm.adm.aem |
This package contains class managing CCSDS Attitude Ephemeris Message.
|
| org.orekit.files.ccsds.ndm.odm.ocm |
This package contains class managing CCSDS Orbit Comprehensive Message.
|
| org.orekit.files.ccsds.ndm.odm.oem |
This package contains class managing CCSDS Orbit Ephemeris Message.
|
| org.orekit.files.ccsds.ndm.odm.omm |
This package contains class managing CCSDS Orbit Mean-Elements Message.
|
| org.orekit.files.ccsds.ndm.odm.opm |
This package contains class managing CCSDS Orbit Parameter Message.
|
| org.orekit.files.general |
This package provides interfaces for orbit file representations and corresponding
parsers.
|
| org.orekit.files.ilrs |
This package provides parsers for laser ranging data stored in CDR and CPF formats.
|
| org.orekit.forces |
This package provides the interface for force models that will be used by the
NumericalPropagator, as well as
some classical spacecraft models for surface forces (spherical, box and solar array ...). |
| org.orekit.forces.drag |
This package provides all drag-related forces.
|
| org.orekit.forces.empirical |
This package provides empirical forces.
|
| org.orekit.forces.gravity |
This package provides all gravity-related forces.
|
| org.orekit.forces.inertia |
This package provides inertial force model.
|
| org.orekit.forces.maneuvers |
This package provides models of simple maneuvers.
|
| org.orekit.forces.maneuvers.jacobians |
Generators for columns of Jacobian matrices related to maneuver parameters.
|
| org.orekit.forces.maneuvers.propulsion |
This package provides propulsion models intended to be used with class
Maneuver. |
| org.orekit.forces.maneuvers.trigger |
This package provides maneuver triggers' models intended to be used with class
Maneuver. |
| org.orekit.forces.radiation |
This package provides all radiation pressure related forces.
|
| org.orekit.models.earth.ionosphere |
This package provides models that simulate the impact of the ionosphere.
|
| org.orekit.orbits |
This package provides classes to represent orbits.
|
| org.orekit.propagation |
Propagation
|
| org.orekit.propagation.analytical |
Top level package for analytical propagators.
|
| org.orekit.propagation.analytical.gnss |
This package provides classes to propagate GNSS orbits.
|
| org.orekit.propagation.analytical.tle |
This package provides classes to read and extrapolate tle's.
|
| org.orekit.propagation.analytical.tle.generation |
This package provides classes related to TLE generation.
|
| org.orekit.propagation.conversion |
This package provides tools to convert a given propagator or a set of
SpacecraftState into another propagator. |
| org.orekit.propagation.events |
This package provides interfaces and classes dealing with events occurring during propagation.
|
| org.orekit.propagation.events.handlers |
This package provides an interface and classes dealing with events occurrence only.
|
| org.orekit.propagation.integration |
Utilities for integration-based propagators (both numerical and semi-analytical).
|
| org.orekit.propagation.numerical |
Top level package for numerical propagators.
|
| org.orekit.propagation.numerical.cr3bp |
Top level package for CR3BP Models used with a numerical propagator.
|
| org.orekit.propagation.sampling |
This package provides interfaces and classes dealing with step handling during propagation.
|
| org.orekit.propagation.semianalytical.dsst |
This package provides an implementation of the Draper Semi-analytical
Satellite Theory (DSST).
|
| org.orekit.propagation.semianalytical.dsst.forces |
This package provides force models for Draper Semi-analytical Satellite Theory (DSST).
|
| org.orekit.utils |
This package provides useful objects.
|
| Modifier and Type | Method and Description |
|---|---|
void |
AttitudesSequence.SwitchHandler.switchOccurred(AttitudeProvider preceding,
AttitudeProvider following,
SpacecraftState state)
Method called when attitude is switched from one law to another law.
|
| Modifier and Type | Method and Description |
|---|---|
SpacecraftState |
GroundReceiverCommonParametersWithoutDerivatives.getState()
Get spacecraft state.
|
SpacecraftState |
GroundReceiverCommonParametersWithDerivatives.getState()
Get spacecraft state.
|
SpacecraftState[] |
EstimatedMeasurementBase.getStates()
Get the states of the spacecrafts.
|
SpacecraftState |
GroundReceiverCommonParametersWithoutDerivatives.getTransitState()
Get transit state.
|
SpacecraftState |
GroundReceiverCommonParametersWithDerivatives.getTransitState()
Get transit state.
|
| Modifier and Type | Method and Description |
|---|---|
protected GroundReceiverCommonParametersWithDerivatives |
GroundReceiverMeasurement.computeCommonParametersWithDerivatives(SpacecraftState state)
Compute common estimation parameters.
|
protected GroundReceiverCommonParametersWithoutDerivatives |
GroundReceiverMeasurement.computeCommonParametersWithout(SpacecraftState state)
Compute common estimation parameters.
|
EstimatedMeasurement<T> |
ObservedMeasurement.estimate(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value of the measurement, with derivatives.
|
EstimatedMeasurement<T> |
AbstractMeasurement.estimate(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value of the measurement, with derivatives.
|
EstimatedMeasurementBase<T> |
ObservedMeasurement.estimateWithoutDerivatives(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value of the measurement, without derivatives.
|
EstimatedMeasurementBase<T> |
AbstractMeasurement.estimateWithoutDerivatives(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value of the measurement, without derivatives.
|
static TimeStampedFieldPVCoordinates<org.hipparchus.analysis.differentiation.Gradient> |
AbstractMeasurement.getCoordinates(SpacecraftState state,
int firstDerivative,
int freeParameters)
Get Cartesian coordinates as derivatives.
|
protected EstimatedMeasurement<TurnAroundRange> |
TurnAroundRange.theoreticalEvaluation(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value.
|
protected EstimatedMeasurement<AngularAzEl> |
AngularAzEl.theoreticalEvaluation(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value.
|
protected EstimatedMeasurement<MultiplexedMeasurement> |
MultiplexedMeasurement.theoreticalEvaluation(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value.
|
protected EstimatedMeasurement<BistaticRange> |
BistaticRange.theoreticalEvaluation(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value.
|
protected EstimatedMeasurement<RangeRate> |
RangeRate.theoreticalEvaluation(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value.
|
protected EstimatedMeasurement<PV> |
PV.theoreticalEvaluation(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value.
|
protected EstimatedMeasurement<Position> |
Position.theoreticalEvaluation(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value.
|
protected abstract EstimatedMeasurement<T> |
AbstractMeasurement.theoreticalEvaluation(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value.
|
protected EstimatedMeasurement<InterSatellitesRange> |
InterSatellitesRange.theoreticalEvaluation(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value.
|
protected EstimatedMeasurement<BistaticRangeRate> |
BistaticRangeRate.theoreticalEvaluation(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value.
|
protected EstimatedMeasurement<FDOA> |
FDOA.theoreticalEvaluation(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value.
|
protected EstimatedMeasurement<AngularRaDec> |
AngularRaDec.theoreticalEvaluation(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value.
|
protected EstimatedMeasurement<TDOA> |
TDOA.theoreticalEvaluation(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value.
|
protected EstimatedMeasurement<Range> |
Range.theoreticalEvaluation(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value.
|
protected EstimatedMeasurementBase<TurnAroundRange> |
TurnAroundRange.theoreticalEvaluationWithoutDerivatives(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value without derivatives.
|
protected EstimatedMeasurementBase<AngularAzEl> |
AngularAzEl.theoreticalEvaluationWithoutDerivatives(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value without derivatives.
|
protected EstimatedMeasurementBase<MultiplexedMeasurement> |
MultiplexedMeasurement.theoreticalEvaluationWithoutDerivatives(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value without derivatives.
|
protected EstimatedMeasurementBase<BistaticRange> |
BistaticRange.theoreticalEvaluationWithoutDerivatives(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value without derivatives.
|
protected EstimatedMeasurementBase<RangeRate> |
RangeRate.theoreticalEvaluationWithoutDerivatives(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value without derivatives.
|
protected EstimatedMeasurementBase<PV> |
PV.theoreticalEvaluationWithoutDerivatives(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value without derivatives.
|
protected EstimatedMeasurementBase<Position> |
Position.theoreticalEvaluationWithoutDerivatives(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value without derivatives.
|
protected abstract EstimatedMeasurementBase<T> |
AbstractMeasurement.theoreticalEvaluationWithoutDerivatives(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value without derivatives.
|
protected EstimatedMeasurementBase<InterSatellitesRange> |
InterSatellitesRange.theoreticalEvaluationWithoutDerivatives(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value without derivatives.
|
protected EstimatedMeasurementBase<BistaticRangeRate> |
BistaticRangeRate.theoreticalEvaluationWithoutDerivatives(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value without derivatives.
|
protected EstimatedMeasurementBase<FDOA> |
FDOA.theoreticalEvaluationWithoutDerivatives(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value without derivatives.
|
protected EstimatedMeasurementBase<AngularRaDec> |
AngularRaDec.theoreticalEvaluationWithoutDerivatives(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value without derivatives.
|
protected EstimatedMeasurementBase<TDOA> |
TDOA.theoreticalEvaluationWithoutDerivatives(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value without derivatives.
|
protected EstimatedMeasurementBase<Range> |
Range.theoreticalEvaluationWithoutDerivatives(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value without derivatives.
|
| Constructor and Description |
|---|
EstimatedMeasurement(T observedMeasurement,
int iteration,
int count,
SpacecraftState[] states,
TimeStampedPVCoordinates[] participants)
Simple constructor.
|
EstimatedMeasurementBase(T observedMeasurement,
int iteration,
int count,
SpacecraftState[] states,
TimeStampedPVCoordinates[] participants)
Simple constructor.
|
GroundReceiverCommonParametersWithDerivatives(SpacecraftState state,
Map<String,Integer> indices,
FieldTransform<org.hipparchus.analysis.differentiation.Gradient> offsetToInertialDownlink,
TimeStampedFieldPVCoordinates<org.hipparchus.analysis.differentiation.Gradient> stationDownlink,
org.hipparchus.analysis.differentiation.Gradient tauD,
SpacecraftState transitState,
TimeStampedFieldPVCoordinates<org.hipparchus.analysis.differentiation.Gradient> transitPV)
Simple constructor.
|
GroundReceiverCommonParametersWithoutDerivatives(SpacecraftState state,
Transform offsetToInertialDownlink,
TimeStampedPVCoordinates stationDownlink,
double tauD,
SpacecraftState transitState,
TimeStampedPVCoordinates transitPV)
Simple constructor.
|
| Modifier and Type | Method and Description |
|---|---|
void |
MeasurementFilter.filter(ObservedMeasurement<T> measurement,
SpacecraftState state)
Apply a filter to an observed measurement.
|
void |
ResidualFilter.filter(ObservedMeasurement<T> measurement,
SpacecraftState state)
Apply a filter to an observed measurement.
|
void |
ElevationFilter.filter(ObservedMeasurement<T> measurement,
SpacecraftState state)
Apply a filter to an observed measurement.
|
| Modifier and Type | Method and Description |
|---|---|
protected EstimatedMeasurement<Phase> |
Phase.theoreticalEvaluation(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value.
|
protected EstimatedMeasurement<OneWayGNSSPhase> |
OneWayGNSSPhase.theoreticalEvaluation(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value.
|
protected EstimatedMeasurement<OneWayGNSSRange> |
OneWayGNSSRange.theoreticalEvaluation(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value.
|
protected EstimatedMeasurement<InterSatellitesPhase> |
InterSatellitesPhase.theoreticalEvaluation(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value.
|
protected EstimatedMeasurementBase<Phase> |
Phase.theoreticalEvaluationWithoutDerivatives(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value without derivatives.
|
protected EstimatedMeasurementBase<OneWayGNSSPhase> |
OneWayGNSSPhase.theoreticalEvaluationWithoutDerivatives(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value without derivatives.
|
protected EstimatedMeasurementBase<OneWayGNSSRange> |
OneWayGNSSRange.theoreticalEvaluationWithoutDerivatives(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value without derivatives.
|
protected EstimatedMeasurementBase<InterSatellitesPhase> |
InterSatellitesPhase.theoreticalEvaluationWithoutDerivatives(int iteration,
int evaluation,
SpacecraftState[] states)
Estimate the theoretical value without derivatives.
|
| Modifier and Type | Method and Description |
|---|---|
protected double |
BaseRangeIonosphericDelayModifier.rangeErrorIonosphericModel(GroundStation station,
SpacecraftState state)
Compute the measurement error due to Ionosphere.
|
double |
BaseRangeTroposphericDelayModifier.rangeErrorTroposphericModel(GroundStation station,
SpacecraftState state)
Compute the measurement error due to Troposphere.
|
protected double |
BaseRangeRateIonosphericDelayModifier.rangeRateErrorIonosphericModel(GroundStation station,
SpacecraftState state)
Compute the measurement error due to Ionosphere.
|
protected double |
RangeRateIonosphericDelayModifier.rangeRateErrorIonosphericModel(GroundStation station,
SpacecraftState state)
Compute the measurement error due to Ionosphere.
|
double |
RangeRateTroposphericDelayModifier.rangeRateErrorTroposphericModel(GroundStation station,
SpacecraftState state)
Compute the measurement error due to Troposphere.
|
double |
BaseRangeRateTroposphericDelayModifier.rangeRateErrorTroposphericModel(GroundStation station,
SpacecraftState state)
Compute the measurement error due to Troposphere.
|
| Constructor and Description |
|---|
ModifierGradientConverter(SpacecraftState state,
int freeStateParameters,
AttitudeProvider provider)
Simple constructor.
|
| Modifier and Type | Method and Description |
|---|---|
static SpacecraftState[] |
KalmanEstimatorUtil.filterRelevant(ObservedMeasurement<?> observedMeasurement,
SpacecraftState[] allStates)
Filter relevant states for a measurement.
|
SpacecraftState[] |
UnscentedKalmanModel.getCorrectedSpacecraftStates()
Get the corrected spacecraft states.
|
SpacecraftState[] |
SemiAnalyticalUnscentedKalmanModel.getCorrectedSpacecraftStates()
Get the corrected spacecraft states.
|
SpacecraftState[] |
KalmanModel.getCorrectedSpacecraftStates()
Get the corrected spacecraft states.
|
SpacecraftState[] |
SemiAnalyticalKalmanModel.getCorrectedSpacecraftStates()
Get the corrected spacecraft states.
|
SpacecraftState[] |
KalmanEstimation.getCorrectedSpacecraftStates()
Get the corrected spacecraft states.
|
SpacecraftState[] |
UnscentedKalmanModel.getPredictedSpacecraftStates()
Get the predicted spacecraft states.
|
SpacecraftState[] |
SemiAnalyticalUnscentedKalmanModel.getPredictedSpacecraftStates()
Get the predicted spacecraft states.
|
SpacecraftState[] |
KalmanModel.getPredictedSpacecraftStates()
Get the predicted spacecraft states.
|
SpacecraftState[] |
SemiAnalyticalKalmanModel.getPredictedSpacecraftStates()
Get the predicted spacecraft states.
|
SpacecraftState[] |
KalmanEstimation.getPredictedSpacecraftStates()
Get the predicted spacecraft states.
|
| Modifier and Type | Method and Description |
|---|---|
static SpacecraftState[] |
KalmanEstimatorUtil.filterRelevant(ObservedMeasurement<?> observedMeasurement,
SpacecraftState[] allStates)
Filter relevant states for a measurement.
|
org.hipparchus.linear.RealMatrix |
CovarianceMatrixProvider.getInitialCovarianceMatrix(SpacecraftState initial)
Get the initial covariance matrix.
|
org.hipparchus.linear.RealMatrix |
AbstractCovarianceMatrixProvider.getInitialCovarianceMatrix(SpacecraftState initial)
Get the initial covariance matrix.
|
org.hipparchus.linear.RealMatrix |
CovarianceMatrixProvider.getProcessNoiseMatrix(SpacecraftState previous,
SpacecraftState current)
Get the process noise matrix between previous and current states.
|
org.hipparchus.linear.RealMatrix |
UnivariateProcessNoise.getProcessNoiseMatrix(SpacecraftState previous,
SpacecraftState current)
Get the process noise matrix between previous and current states.
|
org.hipparchus.linear.RealMatrix |
ConstantProcessNoise.getProcessNoiseMatrix(SpacecraftState previous,
SpacecraftState current)
Get the process noise matrix between previous and current states.
|
void |
SemiAnalyticalMeasurementHandler.init(SpacecraftState s0,
AbsoluteDate t)
Initialize step handler at the start of a propagation.
|
void |
SemiAnalyticalUnscentedKalmanModel.initializeShortPeriodicTerms(SpacecraftState meanState)
Initialize the short periodic terms for the Kalman Filter.
|
void |
SemiAnalyticalKalmanModel.initializeShortPeriodicTerms(SpacecraftState meanState)
Initialize the short periodic terms for the Kalman Filter.
|
void |
SemiAnalyticalProcess.initializeShortPeriodicTerms(SpacecraftState meanState)
Initialize the short periodic terms for the Kalman Filter.
|
void |
SemiAnalyticalUnscentedKalmanModel.updateNominalSpacecraftState(SpacecraftState nominal)
Update the nominal spacecraft state.
|
void |
SemiAnalyticalKalmanModel.updateNominalSpacecraftState(SpacecraftState nominal)
Update the nominal spacecraft state.
|
void |
SemiAnalyticalProcess.updateNominalSpacecraftState(SpacecraftState nominal)
Update the nominal spacecraft state.
|
void |
SemiAnalyticalUnscentedKalmanModel.updateShortPeriods(SpacecraftState state)
Update the DSST short periodic terms.
|
void |
SemiAnalyticalKalmanModel.updateShortPeriods(SpacecraftState state)
Update the DSST short periodic terms.
|
void |
SemiAnalyticalProcess.updateShortPeriods(SpacecraftState state)
Update the DSST short periodic terms.
|
| Modifier and Type | Method and Description |
|---|---|
void |
StreamingAemWriter.SegmentWriter.finish(SpacecraftState finalState)
Finalize propagation.
|
void |
StreamingAemWriter.SegmentWriter.handleStep(SpacecraftState currentState)
Handle the current step.
|
void |
StreamingAemWriter.SegmentWriter.init(SpacecraftState s0,
AbsoluteDate t,
double step)
Initialize step handler at the start of a propagation.
|
| Modifier and Type | Method and Description |
|---|---|
void |
StreamingOcmWriter.BlockWriter.finish(SpacecraftState finalState)
Finalize propagation.
|
void |
StreamingOcmWriter.BlockWriter.handleStep(SpacecraftState currentState)
Handle the current step.
|
void |
StreamingOcmWriter.BlockWriter.init(SpacecraftState s0,
AbsoluteDate t,
double step)
Initialize step handler at the start of a propagation.
|
| Modifier and Type | Method and Description |
|---|---|
void |
StreamingOemWriter.SegmentWriter.finish(SpacecraftState finalState)
Finalize propagation.
|
void |
StreamingOemWriter.SegmentWriter.handleStep(SpacecraftState currentState)
Handle the current step.
|
void |
StreamingOemWriter.SegmentWriter.init(SpacecraftState s0,
AbsoluteDate t,
double step)
Initialize step handler at the start of a propagation.
|
| Modifier and Type | Method and Description |
|---|---|
SpacecraftState |
Omm.generateSpacecraftState()
Generate spacecraft state from the
CartesianOrbit generated by generateCartesianOrbit. |
| Modifier and Type | Method and Description |
|---|---|
SpacecraftState |
Opm.generateSpacecraftState()
Generate spacecraft state from the
CartesianOrbit generated by generateCartesianOrbit. |
| Modifier and Type | Method and Description |
|---|---|
OrekitEphemerisFile.OrekitEphemerisSegment |
OrekitEphemerisFile.OrekitSatelliteEphemeris.addNewSegment(List<SpacecraftState> states)
Injects pre-computed satellite states into this ephemeris file
object, returning the generated
OrekitEphemerisFile.OrekitEphemerisSegment that
has been stored internally. |
OrekitEphemerisFile.OrekitEphemerisSegment |
OrekitEphemerisFile.OrekitSatelliteEphemeris.addNewSegment(List<SpacecraftState> states,
CelestialBody body,
int interpolationSampleSize)
Injects pre-computed satellite states into this ephemeris file
object, returning the generated
OrekitEphemerisFile.OrekitEphemerisSegment that
has been stored internally. |
OrekitEphemerisFile.OrekitEphemerisSegment |
OrekitEphemerisFile.OrekitSatelliteEphemeris.addNewSegment(List<SpacecraftState> states,
CelestialBody body,
int interpolationSampleSize,
TimeScale timeScale)
Injects pre-computed satellite states into this ephemeris file
object, returning the generated
OrekitEphemerisFile.OrekitEphemerisSegment that
has been stored internally. |
OrekitEphemerisFile.OrekitEphemerisSegment |
OrekitEphemerisFile.OrekitSatelliteEphemeris.addNewSegment(List<SpacecraftState> states,
int interpolationSampleSize)
Injects pre-computed satellite states into this ephemeris file
object, returning the generated
OrekitEphemerisFile.OrekitEphemerisSegment that
has been stored internally. |
OrekitAttitudeEphemerisFile.OrekitAttitudeEphemerisSegment |
OrekitAttitudeEphemerisFile.OrekitSatelliteAttitudeEphemeris.addNewSegment(List<SpacecraftState> states,
String interpolationMethod,
int interpolationSamples,
AngularDerivativesFilter availableDerivatives)
Injects pre-computed satellite states into this attitude ephemeris file
object, returning the generated
OrekitAttitudeEphemerisFile.OrekitAttitudeEphemerisSegment that
has been stored internally. |
| Modifier and Type | Method and Description |
|---|---|
void |
StreamingCpfWriter.Segment.finish(SpacecraftState finalState)
Finalize propagation.
|
void |
StreamingCpfWriter.Segment.handleStep(SpacecraftState currentState)
Handle the current step.
|
| Modifier and Type | Method and Description |
|---|---|
org.hipparchus.geometry.euclidean.threed.Vector3D |
ForceModel.acceleration(SpacecraftState s,
double[] parameters)
Compute acceleration.
|
default void |
ForceModel.addContribution(SpacecraftState s,
TimeDerivativesEquations adder)
Compute the contribution of the force model to the perturbing
acceleration.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
BoxAndSolarArraySpacecraft.dragAcceleration(SpacecraftState state,
double density,
org.hipparchus.geometry.euclidean.threed.Vector3D relativeVelocity,
double[] parameters)
Compute the acceleration due to drag.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
FixedPanel.getNormal(SpacecraftState state)
Get panel normal in spacecraft frame.
|
abstract org.hipparchus.geometry.euclidean.threed.Vector3D |
Panel.getNormal(SpacecraftState state)
Get panel normal in spacecraft frame.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
SlewingPanel.getNormal(SpacecraftState state)
Get panel normal in spacecraft frame.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
PointingPanel.getNormal(SpacecraftState state)
Get panel normal in spacecraft frame.
|
default void |
ForceModel.init(SpacecraftState initialState,
AbsoluteDate target)
Initialize the force model at the start of propagation.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
BoxAndSolarArraySpacecraft.radiationPressureAcceleration(SpacecraftState state,
org.hipparchus.geometry.euclidean.threed.Vector3D flux,
double[] parameters)
Compute the acceleration due to radiation pressure.
|
| Modifier and Type | Method and Description |
|---|---|
org.hipparchus.geometry.euclidean.threed.Vector3D |
TimeSpanDragForce.acceleration(SpacecraftState s,
double[] parameters)
Compute acceleration.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
DragForce.acceleration(SpacecraftState s,
double[] parameters)
Compute acceleration.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
DragSensitive.dragAcceleration(SpacecraftState state,
double density,
org.hipparchus.geometry.euclidean.threed.Vector3D relativeVelocity,
double[] parameters)
Compute the acceleration due to drag.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
IsotropicDrag.dragAcceleration(SpacecraftState state,
double density,
org.hipparchus.geometry.euclidean.threed.Vector3D relativeVelocity,
double[] parameters)
Compute the acceleration due to drag.
|
| Modifier and Type | Method and Description |
|---|---|
org.hipparchus.geometry.euclidean.threed.Vector3D |
TimeSpanParametricAcceleration.acceleration(SpacecraftState state,
double[] parameters)
Compute acceleration.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
ParametricAcceleration.acceleration(SpacecraftState state,
double[] parameters)
Compute acceleration.
|
void |
PolynomialAccelerationModel.init(SpacecraftState initialState,
AbsoluteDate target)
Initialize the acceleration model at the start of the propagation.
|
void |
TimeSpanParametricAcceleration.init(SpacecraftState initialState,
AbsoluteDate target)
Initialize the force model at the start of propagation.
|
default void |
AccelerationModel.init(SpacecraftState initialState,
AbsoluteDate target)
Initialize the acceleration model at the start of the propagation.
|
void |
ParametricAcceleration.init(SpacecraftState initialState,
AbsoluteDate target)
Initialize the force model at the start of propagation.
|
void |
HarmonicAccelerationModel.init(SpacecraftState initialState,
AbsoluteDate target)
Initialize the acceleration model at the start of the propagation.
|
double |
PolynomialAccelerationModel.signedAmplitude(SpacecraftState state,
double[] parameters)
Compute the signed amplitude of the acceleration.
|
double |
AccelerationModel.signedAmplitude(SpacecraftState state,
double[] parameters)
Compute the signed amplitude of the acceleration.
|
double |
HarmonicAccelerationModel.signedAmplitude(SpacecraftState state,
double[] parameters)
Compute the signed amplitude of the acceleration.
|
| Modifier and Type | Method and Description |
|---|---|
org.hipparchus.geometry.euclidean.threed.Vector3D |
SingleBodyAbsoluteAttraction.acceleration(SpacecraftState s,
double[] parameters)
Compute acceleration.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
LenseThirringRelativity.acceleration(SpacecraftState s,
double[] parameters)
Compute acceleration.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
NewtonianAttraction.acceleration(SpacecraftState s,
double[] parameters)
Compute acceleration.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
HolmesFeatherstoneAttractionModel.acceleration(SpacecraftState s,
double[] parameters)
Compute acceleration.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
DeSitterRelativity.acceleration(SpacecraftState s,
double[] parameters)
Compute acceleration.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
SolidTides.acceleration(SpacecraftState s,
double[] parameters)
Compute acceleration.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
OceanTides.acceleration(SpacecraftState s,
double[] parameters)
Compute acceleration.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
Relativity.acceleration(SpacecraftState s,
double[] parameters)
Compute acceleration.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
ThirdBodyAttraction.acceleration(SpacecraftState s,
double[] parameters)
Compute acceleration.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
SingleBodyRelativeAttraction.acceleration(SpacecraftState s,
double[] parameters)
Compute acceleration.
|
void |
NewtonianAttraction.addContribution(SpacecraftState s,
TimeDerivativesEquations adder)
Compute the contribution of the force model to the perturbing
acceleration.
|
double[] |
ThirdBodyAttractionEpoch.getDerivativesToEpoch(SpacecraftState s,
double[] parameters)
Compute derivatives of the state w.r.t epoch.
|
| Modifier and Type | Method and Description |
|---|---|
org.hipparchus.geometry.euclidean.threed.Vector3D |
InertialForces.acceleration(SpacecraftState s,
double[] parameters)
Compute acceleration.
|
| Modifier and Type | Method and Description |
|---|---|
SpacecraftState |
SmallManeuverAnalyticalModel.apply(SpacecraftState state1)
Compute the effect of the maneuver on a spacecraft state.
|
| Modifier and Type | Method and Description |
|---|---|
org.hipparchus.geometry.euclidean.threed.Vector3D |
Maneuver.acceleration(SpacecraftState s,
double[] parameters) |
void |
Maneuver.addContribution(SpacecraftState s,
TimeDerivativesEquations adder)
Compute the contribution of the force model to the perturbing
acceleration.
|
SpacecraftState |
SmallManeuverAnalyticalModel.apply(SpacecraftState state1)
Compute the effect of the maneuver on a spacecraft state.
|
double |
ImpulseManeuver.g(SpacecraftState s)
Compute the value of the switching function.
|
void |
Maneuver.init(SpacecraftState initialState,
AbsoluteDate target)
Initialize the force model at the start of propagation.
|
void |
ImpulseManeuver.init(SpacecraftState s0,
AbsoluteDate t)
Initialize event handler at the start of a propagation.
|
boolean |
ConstantThrustManeuver.isFiring(SpacecraftState s)
Check if maneuvering is on.
|
| Constructor and Description |
|---|
SmallManeuverAnalyticalModel(SpacecraftState state0,
Frame frame,
org.hipparchus.geometry.euclidean.threed.Vector3D dV,
double isp)
Build a maneuver defined in user-specified frame.
|
SmallManeuverAnalyticalModel(SpacecraftState state0,
org.hipparchus.geometry.euclidean.threed.Vector3D dV,
double isp)
Build a maneuver defined in spacecraft frame.
|
| Modifier and Type | Method and Description |
|---|---|
SpacecraftState |
TriggerDate.resetState(SpacecraftState state)
Reset state as a maneuver triggers.
|
| Modifier and Type | Method and Description |
|---|---|
CombinedDerivatives |
MassDepletionDelay.combinedDerivatives(SpacecraftState state)
Compute the derivatives related to the additional state (and optionally main state increments).
|
double[] |
MedianDate.getAdditionalState(SpacecraftState state)
Get the additional state.
|
double[] |
Duration.getAdditionalState(SpacecraftState state)
Get the additional state.
|
double[] |
TriggerDate.getAdditionalState(SpacecraftState state)
Get the additional state.
|
void |
MassDepletionDelay.init(SpacecraftState initialState,
AbsoluteDate target)
Initialize the generator at the start of propagation.
|
void |
TriggerDate.init(SpacecraftState initialState,
AbsoluteDate target)
Initialize the additional state provider at the start of propagation.
|
void |
TriggerDate.maneuverTriggered(SpacecraftState state,
boolean start)
Observe a maneuver trigger.
|
SpacecraftState |
TriggerDate.resetState(SpacecraftState state)
Reset state as a maneuver triggers.
|
boolean |
MedianDate.yields(SpacecraftState state)
Check if this provider should yield so another provider has an opportunity to add missing parts.
|
boolean |
Duration.yields(SpacecraftState state)
Check if this provider should yield so another provider has an opportunity to add missing parts.
|
boolean |
TriggerDate.yields(SpacecraftState state)
Check if this provider should yield so another provider has an opportunity to add missing parts.
|
| Modifier and Type | Method and Description |
|---|---|
default org.hipparchus.geometry.euclidean.threed.Vector3D |
ThrustPropulsionModel.getAcceleration(SpacecraftState s,
Attitude maneuverAttitude,
double[] parameters)
Get the acceleration of the spacecraft during maneuver and in maneuver frame.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
PropulsionModel.getAcceleration(SpacecraftState s,
Attitude maneuverAttitude,
double[] parameters)
Get the acceleration of the spacecraft during maneuver and in maneuver frame.
|
default org.hipparchus.geometry.euclidean.threed.Vector3D |
ThrustPropulsionModel.getDirection(SpacecraftState s)
Get the thrust direction in spacecraft frame.
|
double |
ProfileThrustPropulsionModel.getFlowRate(SpacecraftState s)
Get the flow rate (kg/s).
|
double |
ThrustPropulsionModel.getFlowRate(SpacecraftState s)
Get the flow rate (kg/s).
|
double |
AbstractConstantThrustPropulsionModel.getFlowRate(SpacecraftState s)
Get the flow rate (kg/s).
|
double |
ProfileThrustPropulsionModel.getFlowRate(SpacecraftState s,
double[] parameters)
Get the flow rate (kg/s).
|
double |
ThrustPropulsionModel.getFlowRate(SpacecraftState s,
double[] parameters)
Get the flow rate (kg/s).
|
double |
AbstractConstantThrustPropulsionModel.getFlowRate(SpacecraftState s,
double[] parameters)
Get the flow rate (kg/s).
|
default double |
ThrustPropulsionModel.getIsp(SpacecraftState s)
Get the specific impulse (s).
|
default double |
ThrustPropulsionModel.getMassDerivatives(SpacecraftState s,
double[] parameters)
Get the mass derivative (i.e.
|
double |
PropulsionModel.getMassDerivatives(SpacecraftState s,
double[] parameters)
Get the mass derivative (i.e.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
ProfileThrustPropulsionModel.getThrustVector(SpacecraftState s)
Get the thrust vector in spacecraft frame (N).
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
ThrustPropulsionModel.getThrustVector(SpacecraftState s)
Get the thrust vector in spacecraft frame (N).
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
AbstractConstantThrustPropulsionModel.getThrustVector(SpacecraftState s)
Get the thrust vector in spacecraft frame (N).
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
ProfileThrustPropulsionModel.getThrustVector(SpacecraftState s,
double[] parameters)
Get the thrust vector in spacecraft frame (N).
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
ThrustPropulsionModel.getThrustVector(SpacecraftState s,
double[] parameters)
Get the thrust vector in spacecraft frame (N).
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
AbstractConstantThrustPropulsionModel.getThrustVector(SpacecraftState s,
double[] parameters)
Get the thrust vector in spacecraft frame (N).
|
default void |
PropulsionModel.init(SpacecraftState initialState,
AbsoluteDate target)
Initialization method.
|
| Modifier and Type | Method and Description |
|---|---|
protected SpacecraftState |
AbstractManeuverTriggers.applyResetters(SpacecraftState state)
Apply resetters.
|
SpacecraftState |
ManeuverTriggersResetter.resetState(SpacecraftState state)
Reset state as a maneuver triggers.
|
| Modifier and Type | Method and Description |
|---|---|
protected SpacecraftState |
AbstractManeuverTriggers.applyResetters(SpacecraftState state)
Apply resetters.
|
default void |
ManeuverTriggersResetter.init(SpacecraftState initialState,
AbsoluteDate target)
Initialization method called at propagation start.
|
void |
AbstractManeuverTriggers.init(SpacecraftState initialState,
AbsoluteDate target)
Initialization method called at propagation start.
|
default void |
ManeuverTriggers.init(SpacecraftState initialState,
AbsoluteDate target)
Initialization method called at propagation start.
|
void |
StartStopEventsTrigger.init(SpacecraftState initialState,
AbsoluteDate target)
Initialization method called at propagation start.
|
protected void |
AbstractManeuverTriggers.initializeResetters(SpacecraftState initialState,
AbsoluteDate target)
Initialize resetters.
|
protected abstract boolean |
AbstractManeuverTriggers.isFiringOnInitialState(SpacecraftState initialState,
boolean isForward)
Method to check if the thruster is firing on initialization.
|
protected boolean |
IntervalEventTrigger.isFiringOnInitialState(SpacecraftState initialState,
boolean isForward)
Method to check if the thruster is firing on initialization.
|
protected boolean |
StartStopEventsTrigger.isFiringOnInitialState(SpacecraftState initialState,
boolean isForward)
Method to check if the thruster is firing on initialization.
|
void |
ManeuverTriggersResetter.maneuverTriggered(SpacecraftState state,
boolean start)
Observe a maneuver trigger.
|
protected void |
AbstractManeuverTriggers.notifyResetters(SpacecraftState state,
boolean start)
Notify resetters.
|
SpacecraftState |
ManeuverTriggersResetter.resetState(SpacecraftState state)
Reset state as a maneuver triggers.
|
| Modifier and Type | Method and Description |
|---|---|
org.hipparchus.geometry.euclidean.threed.Vector3D |
KnockeRediffusedForceModel.acceleration(SpacecraftState s,
double[] parameters)
Compute acceleration.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
SolarRadiationPressure.acceleration(SpacecraftState s,
double[] parameters)
Compute acceleration.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
ECOM2.acceleration(SpacecraftState s,
double[] parameters)
Compute acceleration.
|
double |
SolarRadiationPressure.getLightingRatio(SpacecraftState state)
Get the lighting ratio ([0-1]).
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
IsotropicRadiationClassicalConvention.radiationPressureAcceleration(SpacecraftState state,
org.hipparchus.geometry.euclidean.threed.Vector3D flux,
double[] parameters)
Compute the acceleration due to radiation pressure.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
IsotropicRadiationSingleCoefficient.radiationPressureAcceleration(SpacecraftState state,
org.hipparchus.geometry.euclidean.threed.Vector3D flux,
double[] parameters)
Compute the acceleration due to radiation pressure.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
RadiationSensitive.radiationPressureAcceleration(SpacecraftState state,
org.hipparchus.geometry.euclidean.threed.Vector3D flux,
double[] parameters)
Compute the acceleration due to radiation pressure.
|
org.hipparchus.geometry.euclidean.threed.Vector3D |
IsotropicRadiationCNES95Convention.radiationPressureAcceleration(SpacecraftState state,
org.hipparchus.geometry.euclidean.threed.Vector3D flux,
double[] parameters)
Compute the acceleration due to radiation pressure.
|
| Modifier and Type | Method and Description |
|---|---|
double |
IonosphericModel.pathDelay(SpacecraftState state,
TopocentricFrame baseFrame,
double frequency,
double[] parameters)
Calculates the ionospheric path delay for the signal path from a ground
station to a satellite.
|
double |
GlobalIonosphereMapModel.pathDelay(SpacecraftState state,
TopocentricFrame baseFrame,
double frequency,
double[] parameters) |
double |
EstimatedIonosphericModel.pathDelay(SpacecraftState state,
TopocentricFrame baseFrame,
double frequency,
double[] parameters)
Calculates the ionospheric path delay for the signal path from a ground
station to a satellite.
|
double |
KlobucharIonoModel.pathDelay(SpacecraftState state,
TopocentricFrame baseFrame,
double frequency,
double[] parameters)
Calculates the ionospheric path delay for the signal path from a ground
station to a satellite.
|
double |
NeQuickModel.pathDelay(SpacecraftState state,
TopocentricFrame baseFrame,
double frequency,
double[] parameters) |
double |
SsrVtecIonosphericModel.pathDelay(SpacecraftState state,
TopocentricFrame baseFrame,
double frequency,
double[] parameters)
Calculates the ionospheric path delay for the signal path from a ground
station to a satellite.
|
| Modifier and Type | Method and Description |
|---|---|
PVCoordinates |
LibrationOrbit.getManifolds(SpacecraftState s,
boolean isStable)
Return a manifold direction from one position on a libration Orbit.
|
| Modifier and Type | Method and Description |
|---|---|
SpacecraftState |
SpacecraftState.addAdditionalState(String name,
double... value)
Add an additional state.
|
SpacecraftState |
SpacecraftState.addAdditionalStateDerivative(String name,
double... value)
Add an additional state derivative.
|
SpacecraftState |
Propagator.getInitialState()
Get the propagator initial state.
|
SpacecraftState |
AbstractPropagator.getInitialState()
Get the propagator initial state.
|
SpacecraftState |
SpacecraftStateInterpolator.interpolate(AbsoluteDate interpolationDate,
Collection<SpacecraftState> sample)
Get an interpolated instance.
|
protected SpacecraftState |
SpacecraftStateInterpolator.interpolate(AbstractTimeInterpolator.InterpolationData interpolationData)
Interpolate instance from given interpolation data.
|
SpacecraftState |
Propagator.propagate(AbsoluteDate target)
Propagate towards a target date.
|
SpacecraftState |
AbstractPropagator.propagate(AbsoluteDate target)
Propagate towards a target date.
|
SpacecraftState |
Propagator.propagate(AbsoluteDate start,
AbsoluteDate target)
Propagate from a start date towards a target date.
|
SpacecraftState |
SpacecraftState.shiftedBy(double dt)
Get a time-shifted state.
|
SpacecraftState |
FieldSpacecraftState.toSpacecraftState()
To convert a FieldSpacecraftState instance into a SpacecraftState instance.
|
protected SpacecraftState |
AbstractPropagator.updateAdditionalStates(SpacecraftState original)
Update state by adding all additional states.
|
protected SpacecraftState |
AbstractPropagator.updateUnmanagedStates(SpacecraftState original)
Update state by adding unmanaged states.
|
| Modifier and Type | Method and Description |
|---|---|
List<SpacecraftState> |
PropagatorsParallelizer.propagate(AbsoluteDate start,
AbsoluteDate target)
Propagate from a start date towards a target date.
|
| Modifier and Type | Method and Description |
|---|---|
void |
SpacecraftState.ensureCompatibleAdditionalStates(SpacecraftState state)
Check if two instances have the same set of additional states available.
|
double[] |
StateCovarianceMatrixProvider.getAdditionalState(SpacecraftState state)
Get the additional state.
|
double[] |
AdditionalStateProvider.getAdditionalState(SpacecraftState state)
Get the additional state.
|
protected double[][] |
AbstractMatricesHarvester.getConversionJacobian(SpacecraftState state)
Get the conversion Jacobian between state parameters and parameters used for derivatives.
|
org.hipparchus.linear.RealMatrix |
AbstractMatricesHarvester.getParametersJacobian(SpacecraftState state)
Get the Jacobian with respect to propagation parameters.
|
org.hipparchus.linear.RealMatrix |
MatricesHarvester.getParametersJacobian(SpacecraftState state)
Get the Jacobian with respect to propagation parameters.
|
StateCovariance |
StateCovarianceMatrixProvider.getStateCovariance(SpacecraftState state)
Get the state covariance in the same frame/local orbital frame, orbit type and position angle as the initial
covariance.
|
StateCovariance |
StateCovarianceMatrixProvider.getStateCovariance(SpacecraftState state,
Frame frame)
Get the state covariance expressed in a given frame.
|
StateCovariance |
StateCovarianceMatrixProvider.getStateCovariance(SpacecraftState state,
OrbitType orbitType,
PositionAngleType angleType)
Get the state covariance expressed in a given orbit type.
|
org.hipparchus.linear.RealMatrix |
AbstractMatricesHarvester.getStateTransitionMatrix(SpacecraftState state)
Extract state transition matrix from state.
|
org.hipparchus.linear.RealMatrix |
MatricesHarvester.getStateTransitionMatrix(SpacecraftState state)
Extract state transition matrix from state.
|
void |
StateCovarianceMatrixProvider.init(SpacecraftState initialState,
AbsoluteDate target)
Initialize the additional state provider at the start of propagation.
|
default void |
AdditionalStateProvider.init(SpacecraftState initialState,
AbsoluteDate target)
Initialize the additional state provider at the start of propagation.
|
void |
Propagator.resetInitialState(SpacecraftState state)
Reset the propagator initial state.
|
void |
AbstractPropagator.resetInitialState(SpacecraftState state)
Reset the propagator initial state.
|
void |
AbstractMatricesHarvester.setReferenceState(SpacecraftState reference)
Set up reference state.
|
void |
MatricesHarvester.setReferenceState(SpacecraftState reference)
Set up reference state.
|
protected void |
AbstractPropagator.stateChanged(SpacecraftState state)
Notify about a state change.
|
protected SpacecraftState |
AbstractPropagator.updateAdditionalStates(SpacecraftState original)
Update state by adding all additional states.
|
protected SpacecraftState |
AbstractPropagator.updateUnmanagedStates(SpacecraftState original)
Update state by adding unmanaged states.
|
boolean |
StateCovarianceMatrixProvider.yields(SpacecraftState state)
Check if this provider should yield so another provider has an opportunity to add missing parts.
|
default boolean |
AdditionalStateProvider.yields(SpacecraftState state)
Check if this provider should yield so another provider has an opportunity to add missing parts.
|
| Modifier and Type | Method and Description |
|---|---|
static void |
SpacecraftStateInterpolator.checkSampleAndInterpolatorConsistency(List<SpacecraftState> sample,
boolean orbitInterpolatorIsPresent,
boolean absPVInterpolatorIsPresent)
Check that an interpolator exist for given sample state definition.
|
static void |
SpacecraftStateInterpolator.checkStatesDefinitionsConsistency(List<SpacecraftState> states)
Check that all state are either orbit defined or based on absolute position-velocity-acceleration.
|
SpacecraftState |
SpacecraftStateInterpolator.interpolate(AbsoluteDate interpolationDate,
Collection<SpacecraftState> sample)
Get an interpolated instance.
|
| Constructor and Description |
|---|
FieldSpacecraftState(org.hipparchus.Field<T> field,
SpacecraftState state)
Convert a
FieldSpacecraftState. |
| Modifier and Type | Method and Description |
|---|---|
protected SpacecraftState |
AbstractAnalyticalPropagator.acceptStep(OrekitStepInterpolator interpolator,
AbsoluteDate target)
Accept a step, triggering events and step handlers.
|
SpacecraftState |
AdapterPropagator.DifferentialEffect.apply(SpacecraftState original)
Apply the effect to a
spacecraft state. |
SpacecraftState |
J2DifferentialEffect.apply(SpacecraftState state1)
Apply the effect to a
spacecraft state. |
protected SpacecraftState |
AdapterPropagator.basicPropagate(AbsoluteDate date)
Propagate an orbit without any fancy features.
|
protected SpacecraftState |
AggregateBoundedPropagator.basicPropagate(AbsoluteDate date) |
protected SpacecraftState |
AbstractAnalyticalPropagator.basicPropagate(AbsoluteDate date)
Propagate an orbit without any fancy features.
|
SpacecraftState |
Ephemeris.basicPropagate(AbsoluteDate date)
Propagate an orbit without any fancy features.
|
SpacecraftState |
AdapterPropagator.getInitialState()
Get the propagator initial state.
|
SpacecraftState |
AggregateBoundedPropagator.getInitialState() |
SpacecraftState |
Ephemeris.getInitialState()
Get the propagator initial state.
|
SpacecraftState |
AbstractAnalyticalPropagator.propagate(AbsoluteDate start,
AbsoluteDate target)
Propagate from a start date towards a target date.
|
| Modifier and Type | Method and Description |
|---|---|
TimeInterpolator<SpacecraftState> |
Ephemeris.getStateInterpolator()
Get state interpolator.
|
| Modifier and Type | Method and Description |
|---|---|
SpacecraftState |
AdapterPropagator.DifferentialEffect.apply(SpacecraftState original)
Apply the effect to a
spacecraft state. |
SpacecraftState |
J2DifferentialEffect.apply(SpacecraftState state1)
Apply the effect to a
spacecraft state. |
double[] |
AbstractAnalyticalMatricesHarvester.getAdditionalState(SpacecraftState state)
Get the additional state.
|
org.hipparchus.linear.RealMatrix |
AbstractAnalyticalMatricesHarvester.getParametersJacobian(SpacecraftState state)
Get the Jacobian with respect to propagation parameters.
|
org.hipparchus.linear.RealMatrix |
AbstractAnalyticalMatricesHarvester.getStateTransitionMatrix(SpacecraftState state)
Extract state transition matrix from state.
|
void |
EcksteinHechlerPropagator.resetInitialState(SpacecraftState state)
Reset the propagator initial state.
|
void |
AdapterPropagator.resetInitialState(SpacecraftState state)
Reset the propagator initial state.
|
void |
AggregateBoundedPropagator.resetInitialState(SpacecraftState state) |
void |
Ephemeris.resetInitialState(SpacecraftState state)
Try (and fail) to reset the initial state.
|
void |
KeplerianPropagator.resetInitialState(SpacecraftState state)
Reset the propagator initial state.
|
void |
BrouwerLyddanePropagator.resetInitialState(SpacecraftState state)
Reset the propagator initial state.
|
void |
EcksteinHechlerPropagator.resetInitialState(SpacecraftState state,
PropagationType stateType)
Reset the propagator initial state.
|
void |
BrouwerLyddanePropagator.resetInitialState(SpacecraftState state,
PropagationType stateType)
Reset the propagator initial state.
|
void |
EcksteinHechlerPropagator.resetInitialState(SpacecraftState state,
PropagationType stateType,
double epsilon,
int maxIterations)
Reset the propagator initial state.
|
void |
BrouwerLyddanePropagator.resetInitialState(SpacecraftState state,
PropagationType stateType,
double epsilon,
int maxIterations)
Reset the propagator initial state.
|
protected void |
EcksteinHechlerPropagator.resetIntermediateState(SpacecraftState state,
boolean forward)
Reset an intermediate state.
|
protected void |
AdapterPropagator.resetIntermediateState(SpacecraftState state,
boolean forward)
Reset an intermediate state.
|
protected void |
AggregateBoundedPropagator.resetIntermediateState(SpacecraftState state,
boolean forward) |
protected abstract void |
AbstractAnalyticalPropagator.resetIntermediateState(SpacecraftState state,
boolean forward)
Reset an intermediate state.
|
protected void |
Ephemeris.resetIntermediateState(SpacecraftState state,
boolean forward)
Reset an intermediate state.
|
protected void |
KeplerianPropagator.resetIntermediateState(SpacecraftState state,
boolean forward)
Reset an intermediate state.
|
protected void |
BrouwerLyddanePropagator.resetIntermediateState(SpacecraftState state,
boolean forward)
Reset an intermediate state.
|
protected void |
EcksteinHechlerPropagator.resetIntermediateState(SpacecraftState state,
boolean forward,
double epsilon,
int maxIterations)
Reset an intermediate state.
|
protected void |
BrouwerLyddanePropagator.resetIntermediateState(SpacecraftState state,
boolean forward,
double epsilon,
int maxIterations)
Reset an intermediate state.
|
void |
AbstractAnalyticalMatricesHarvester.setReferenceState(SpacecraftState reference)
Set up reference state.
|
| Modifier and Type | Method and Description |
|---|---|
static void |
Ephemeris.checkInputConsistency(List<SpacecraftState> states,
TimeInterpolator<SpacecraftState> stateInterpolator,
List<StateCovariance> covariances,
TimeInterpolator<TimeStampedPair<Orbit,StateCovariance>> covarianceInterpolator)
Check input consistency between states, covariances and their associated interpolators.
|
static void |
Ephemeris.checkInputConsistency(List<SpacecraftState> states,
TimeInterpolator<SpacecraftState> stateInterpolator,
List<StateCovariance> covariances,
TimeInterpolator<TimeStampedPair<Orbit,StateCovariance>> covarianceInterpolator)
Check input consistency between states, covariances and their associated interpolators.
|
static void |
Ephemeris.checkStatesAndCovariancesConsistency(List<SpacecraftState> states,
List<StateCovariance> covariances)
Check that given states and covariances are consistent.
|
| Constructor and Description |
|---|
J2DifferentialEffect(SpacecraftState original,
AdapterPropagator.DifferentialEffect directEffect,
boolean applyBefore,
double referenceRadius,
double mu,
double j2)
Simple constructor.
|
J2DifferentialEffect(SpacecraftState original,
AdapterPropagator.DifferentialEffect directEffect,
boolean applyBefore,
UnnormalizedSphericalHarmonicsProvider gravityField)
Simple constructor.
|
| Constructor and Description |
|---|
Ephemeris(List<SpacecraftState> states,
int interpolationPoints)
Legacy constructor with tabulated states and default Hermite interpolation.
|
Ephemeris(List<SpacecraftState> states,
TimeInterpolator<SpacecraftState> stateInterpolator)
Constructor with tabulated states.
|
Ephemeris(List<SpacecraftState> states,
TimeInterpolator<SpacecraftState> stateInterpolator)
Constructor with tabulated states.
|
Ephemeris(List<SpacecraftState> states,
TimeInterpolator<SpacecraftState> stateInterpolator,
AttitudeProvider attitudeProvider)
Constructor with tabulated states.
|
Ephemeris(List<SpacecraftState> states,
TimeInterpolator<SpacecraftState> stateInterpolator,
AttitudeProvider attitudeProvider)
Constructor with tabulated states.
|
Ephemeris(List<SpacecraftState> states,
TimeInterpolator<SpacecraftState> stateInterpolator,
List<StateCovariance> covariances,
TimeInterpolator<TimeStampedPair<Orbit,StateCovariance>> covarianceInterpolator)
Constructor with tabulated states and associated covariances.
|
Ephemeris(List<SpacecraftState> states,
TimeInterpolator<SpacecraftState> stateInterpolator,
List<StateCovariance> covariances,
TimeInterpolator<TimeStampedPair<Orbit,StateCovariance>> covarianceInterpolator)
Constructor with tabulated states and associated covariances.
|
Ephemeris(List<SpacecraftState> states,
TimeInterpolator<SpacecraftState> stateInterpolator,
List<StateCovariance> covariances,
TimeInterpolator<TimeStampedPair<Orbit,StateCovariance>> covarianceInterpolator,
AttitudeProvider attitudeProvider)
Constructor with tabulated states and associated covariances.
|
Ephemeris(List<SpacecraftState> states,
TimeInterpolator<SpacecraftState> stateInterpolator,
List<StateCovariance> covariances,
TimeInterpolator<TimeStampedPair<Orbit,StateCovariance>> covarianceInterpolator,
AttitudeProvider attitudeProvider)
Constructor with tabulated states and associated covariances.
|
| Modifier and Type | Method and Description |
|---|---|
double[] |
ClockCorrectionsProvider.getAdditionalState(SpacecraftState state)
Get the additional state.
|
void |
GNSSPropagator.resetInitialState(SpacecraftState state)
Reset the propagator initial state.
|
void |
GLONASSAnalyticalPropagator.resetInitialState(SpacecraftState state)
Reset the propagator initial state.
|
void |
SBASPropagator.resetInitialState(SpacecraftState state)
Reset the propagator initial state.
|
protected void |
GNSSPropagator.resetIntermediateState(SpacecraftState state,
boolean forward)
Reset an intermediate state.
|
protected void |
GLONASSAnalyticalPropagator.resetIntermediateState(SpacecraftState state,
boolean forward)
Reset an intermediate state.
|
protected void |
SBASPropagator.resetIntermediateState(SpacecraftState state,
boolean forward)
Reset an intermediate state.
|
| Modifier and Type | Method and Description |
|---|---|
void |
TLEPropagator.resetInitialState(SpacecraftState state)
Reset the propagator initial state.
|
protected void |
TLEPropagator.resetIntermediateState(SpacecraftState state,
boolean forward)
Reset an intermediate state.
|
static TLE |
TLE.stateToTLE(SpacecraftState state,
TLE templateTLE,
TleGenerationAlgorithm generationAlgorithm)
Convert Spacecraft State into TLE.
|
| Modifier and Type | Method and Description |
|---|---|
TLE |
TleGenerationAlgorithm.generate(SpacecraftState state,
TLE templateTLE)
Generate a TLE from a given spacecraft state and a template TLE.
|
TLE |
LeastSquaresTleGenerationAlgorithm.generate(SpacecraftState state,
TLE templateTLE)
Generate a TLE from a given spacecraft state and a template TLE.
|
TLE |
FixedPointTleGenerationAlgorithm.generate(SpacecraftState state,
TLE templateTLE)
Generate a TLE from a given spacecraft state and a template TLE.
|
| Modifier and Type | Method and Description |
|---|---|
SpacecraftState |
OsculatingToMeanElementsConverter.convert()
Convert an osculating orbit into a mean orbit, in DSST sense.
|
| Modifier and Type | Method and Description |
|---|---|
protected List<SpacecraftState> |
AbstractPropagatorConverter.getSample()
Get the states sample.
|
| Modifier and Type | Method and Description |
|---|---|
Propagator |
PropagatorConverter.convert(List<SpacecraftState> states,
boolean positionOnly,
List<String> freeParameters)
Find the propagator that minimize the mean square error for a sample of
states. |
Propagator |
AbstractPropagatorConverter.convert(List<SpacecraftState> states,
boolean positionOnly,
List<String> freeParameters)
Find the propagator that minimize the mean square error for a sample of
states. |
Propagator |
PropagatorConverter.convert(List<SpacecraftState> states,
boolean positionOnly,
String... freeParameters)
Find the propagator that minimize the mean square error for a sample of
states. |
Propagator |
AbstractPropagatorConverter.convert(List<SpacecraftState> states,
boolean positionOnly,
String... freeParameters)
Find the propagator that minimize the mean square error for a sample of
states. |
| Constructor and Description |
|---|
OsculatingToMeanElementsConverter(SpacecraftState state,
int satelliteRevolution,
Propagator propagator,
double positionScale)
Constructor.
|
| Modifier and Type | Method and Description |
|---|---|
SpacecraftState |
EventState.EventOccurrence.getNewState()
Get the new state for a reset action.
|
SpacecraftState |
EventsLogger.LoggedEvent.getState()
Get the triggering state.
|
| Modifier and Type | Method and Description |
|---|---|
ToDoubleFunction<SpacecraftState> |
FunctionalDetector.getFunction()
Get the switching function.
|
| Modifier and Type | Method and Description |
|---|---|
PVCoordinates |
ExtremumApproachDetector.computeDeltaPV(SpacecraftState s)
Compute the relative PV between primary and secondary objects.
|
double |
AdaptableInterval.currentInterval(SpacecraftState state)
Get the current value of maximal time interval between events handler checks.
|
EventState.EventOccurrence |
EventState.doEvent(SpacecraftState state)
Notify the user's listener of the event.
|
boolean |
EnablingPredicate.eventIsEnabled(SpacecraftState state,
EventDetector detector,
double g)
Compute an event enabling function of state.
|
double |
EventShifter.g(SpacecraftState s)
Compute the value of the switching function.
|
double |
AltitudeDetector.g(SpacecraftState s)
Compute the value of the switching function.
|
double |
FootprintOverlapDetector.g(SpacecraftState s)
Compute the value of the switching function.
|
double |
NegateDetector.g(SpacecraftState s) |
double |
ExtremumApproachDetector.g(SpacecraftState s)
The
g is positive when the primary object is getting further away from the secondary object and is
negative when it is getting closer to it. |
double |
InterSatDirectViewDetector.g(SpacecraftState state)
Compute the value of the switching function.
|
double |
GroundFieldOfViewDetector.g(SpacecraftState s)
Compute the value of the switching function.
|
double |
DateDetector.g(SpacecraftState s)
Compute the value of the switching function.
|
double |
ParameterDrivenDateIntervalDetector.g(SpacecraftState s)
Compute the value of the switching function.
|
double |
EclipseDetector.g(SpacecraftState s)
Compute the value of the switching function.
|
double |
ApsideDetector.g(SpacecraftState s)
Compute the value of the switching function.
|
double |
EventEnablingPredicateFilter.g(SpacecraftState s)
Compute the value of the switching function.
|
double |
HaloXZPlaneCrossingDetector.g(SpacecraftState s)
Compute the value of the detection function.
|
double |
ElevationExtremumDetector.g(SpacecraftState s)
Compute the value of the detection function.
|
double |
LatitudeCrossingDetector.g(SpacecraftState s)
Compute the value of the detection function.
|
double |
BooleanDetector.g(SpacecraftState s) |
double |
FieldOfViewDetector.g(SpacecraftState s)
Compute the value of the switching function.
|
double |
GroundAtNightDetector.g(SpacecraftState state)
Compute the value of the switching function.
|
double |
EventDetector.g(SpacecraftState s)
Compute the value of the switching function.
|
double |
LongitudeExtremumDetector.g(SpacecraftState s)
Compute the value of the detection function.
|
abstract double |
AbstractDetector.g(SpacecraftState s)
Compute the value of the switching function.
|
double |
PositionAngleDetector.g(SpacecraftState s)
Compute the value of the detection function.
|
double |
MagneticFieldDetector.g(SpacecraftState s)
Compute the value of the detection function.
|
double |
AdapterDetector.g(SpacecraftState s)
Compute the value of the switching function.
|
double |
GeographicZoneDetector.g(SpacecraftState s)
Compute the value of the detection function.
|
double |
LongitudeCrossingDetector.g(SpacecraftState s)
Compute the value of the detection function.
|
double |
ElevationDetector.g(SpacecraftState s)
Compute the value of the switching function.
|
double |
LatitudeExtremumDetector.g(SpacecraftState s)
Compute the value of the detection function.
|
double |
EventSlopeFilter.g(SpacecraftState s)
Compute the value of the switching function.
|
double |
FunctionalDetector.g(SpacecraftState s) |
double |
AngularSeparationFromSatelliteDetector.g(SpacecraftState s)
Compute the value of the switching function.
|
double |
AngularSeparationDetector.g(SpacecraftState s)
Compute the value of the switching function.
|
double |
NodeDetector.g(SpacecraftState s)
Compute the value of the switching function.
|
double |
AlignmentDetector.g(SpacecraftState s)
Compute the value of the switching function.
|
double |
ElevationExtremumDetector.getElevation(SpacecraftState s)
Get the elevation value.
|
void |
EventShifter.init(SpacecraftState s0,
AbsoluteDate t)
Initialize event handler at the start of a propagation.
|
void |
NegateDetector.init(SpacecraftState s0,
AbsoluteDate t) |
void |
EventEnablingPredicateFilter.init(SpacecraftState s0,
AbsoluteDate t)
Initialize event handler at the start of a propagation.
|
void |
BooleanDetector.init(SpacecraftState s0,
AbsoluteDate t) |
default void |
EventDetector.init(SpacecraftState s0,
AbsoluteDate t)
Initialize event handler at the start of a propagation.
|
void |
AbstractDetector.init(SpacecraftState s0,
AbsoluteDate t)
Initialize event handler at the start of a propagation.
|
void |
PositionAngleDetector.init(SpacecraftState s0,
AbsoluteDate t)
Initialize event handler at the start of a propagation.
|
void |
MagneticFieldDetector.init(SpacecraftState s0,
AbsoluteDate t)
Initialize event handler at the start of a propagation.
|
void |
EventState.init(SpacecraftState s0,
AbsoluteDate t)
Initialize event handler at the start of a propagation.
|
void |
AdapterDetector.init(SpacecraftState s0,
AbsoluteDate t)
Initialize event handler at the start of a propagation.
|
void |
LongitudeCrossingDetector.init(SpacecraftState s0,
AbsoluteDate t)
Initialize event handler at the start of a propagation.
|
void |
EventSlopeFilter.init(SpacecraftState s0,
AbsoluteDate t)
Initialize event handler at the start of a propagation.
|
boolean |
EventState.tryAdvance(SpacecraftState state,
OrekitStepInterpolator interpolator)
Try to accept the current history up to the given time.
|
| Modifier and Type | Method and Description |
|---|---|
FunctionalDetector |
FunctionalDetector.withFunction(ToDoubleFunction<SpacecraftState> newGFunction)
Create a new event detector with a new g function, keeping all other attributes the
same.
|
| Constructor and Description |
|---|
FunctionalDetector(AdaptableInterval maxCheck,
double threshold,
int maxIter,
EventHandler handler,
ToDoubleFunction<SpacecraftState> function)
Private constructor.
|
| Modifier and Type | Method and Description |
|---|---|
SpacecraftState |
RecordAndContinue.Event.getState()
Get the spacecraft's state at the event.
|
default SpacecraftState |
EventHandler.resetState(EventDetector detector,
SpacecraftState oldState)
Reset the state prior to continue propagation.
|
SpacecraftState |
EventMultipleHandler.resetState(EventDetector detector,
SpacecraftState oldState)
Reset the state prior to continue propagation.
|
| Modifier and Type | Method and Description |
|---|---|
org.hipparchus.ode.events.Action |
StopOnDecreasing.eventOccurred(SpacecraftState s,
EventDetector detector,
boolean increasing)
Handle a detection event and choose what to do next.
|
org.hipparchus.ode.events.Action |
StopOnIncreasing.eventOccurred(SpacecraftState s,
EventDetector detector,
boolean increasing)
Handle a detection event and choose what to do next.
|
org.hipparchus.ode.events.Action |
ContinueOnEvent.eventOccurred(SpacecraftState s,
EventDetector detector,
boolean increasing)
Specific implementation of the eventOccurred interface.
|
org.hipparchus.ode.events.Action |
StopOnEvent.eventOccurred(SpacecraftState s,
EventDetector detector,
boolean increasing)
Specific implementation of the eventOccurred interface.
|
org.hipparchus.ode.events.Action |
RecordAndContinue.eventOccurred(SpacecraftState s,
EventDetector detector,
boolean increasing) |
org.hipparchus.ode.events.Action |
EventHandler.eventOccurred(SpacecraftState s,
EventDetector detector,
boolean increasing)
Handle an event.
|
org.hipparchus.ode.events.Action |
EventMultipleHandler.eventOccurred(SpacecraftState s,
EventDetector detector,
boolean increasing)
Handle an event.
|
default void |
EventHandler.init(SpacecraftState initialState,
AbsoluteDate target,
EventDetector detector)
Initialize event handler at the start of a propagation.
|
void |
EventMultipleHandler.init(SpacecraftState initialState,
AbsoluteDate target,
EventDetector detector)
Initialize event handler at the start of a propagation.
|
default SpacecraftState |
EventHandler.resetState(EventDetector detector,
SpacecraftState oldState)
Reset the state prior to continue propagation.
|
SpacecraftState |
EventMultipleHandler.resetState(EventDetector detector,
SpacecraftState oldState)
Reset the state prior to continue propagation.
|
| Modifier and Type | Method and Description |
|---|---|
protected SpacecraftState |
IntegratedEphemeris.basicPropagate(AbsoluteDate date)
Propagate an orbit without any fancy features.
|
protected SpacecraftState |
AbstractIntegratedPropagator.getInitialIntegrationState()
Get the initial state for integration.
|
SpacecraftState |
IntegratedEphemeris.getInitialState()
Get the propagator initial state.
|
abstract SpacecraftState |
StateMapper.mapArrayToState(AbsoluteDate date,
double[] y,
double[] yDot,
PropagationType type)
Map the raw double components to a spacecraft state.
|
SpacecraftState |
StateMapper.mapArrayToState(double t,
double[] y,
double[] yDot,
PropagationType type)
Map the raw double components to a spacecraft state.
|
SpacecraftState |
AbstractIntegratedPropagator.propagate(AbsoluteDate target)
Propagate towards a target date.
|
SpacecraftState |
AbstractIntegratedPropagator.propagate(AbsoluteDate tStart,
AbsoluteDate tEnd)
Propagate from a start date towards a target date.
|
protected SpacecraftState |
IntegratedEphemeris.updateAdditionalStates(SpacecraftState original)
Update state by adding all additional states.
|
| Modifier and Type | Method and Description |
|---|---|
protected void |
AbstractIntegratedPropagator.beforeIntegration(SpacecraftState initialState,
AbsoluteDate tEnd)
Method called just before integration.
|
protected static FieldSpacecraftState<org.hipparchus.analysis.differentiation.Gradient> |
AbstractGradientConverter.buildBasicGradientSpacecraftState(SpacecraftState state,
int freeStateParameters,
AttitudeProvider provider)
Process a state into a Gradient version without force model parameter.
|
CombinedDerivatives |
AdditionalDerivativesProvider.combinedDerivatives(SpacecraftState s)
Compute the derivatives related to the additional state (and optionally main state increments).
|
double[] |
AbstractIntegratedPropagator.MainStateEquations.computeDerivatives(SpacecraftState state)
Compute differential equations for main state.
|
default void |
AdditionalDerivativesProvider.init(SpacecraftState initialState,
AbsoluteDate target)
Initialize the generator at the start of propagation.
|
default void |
AbstractIntegratedPropagator.MainStateEquations.init(SpacecraftState initialState,
AbsoluteDate target)
Initialize the equations at the start of propagation.
|
abstract void |
StateMapper.mapStateToArray(SpacecraftState state,
double[] y,
double[] yDot)
Map a spacecraft state to raw double components.
|
void |
IntegratedEphemeris.resetInitialState(SpacecraftState state)
Reset the propagator initial state.
|
protected void |
IntegratedEphemeris.resetIntermediateState(SpacecraftState state,
boolean forward)
Reset an intermediate state.
|
protected SpacecraftState |
IntegratedEphemeris.updateAdditionalStates(SpacecraftState original)
Update state by adding all additional states.
|
default boolean |
AdditionalDerivativesProvider.yields(SpacecraftState state)
Check if this provider should yield so another provider has an opportunity to add missing parts.
|
| Modifier and Type | Method and Description |
|---|---|
SpacecraftState |
GLONASSNumericalPropagator.propagate(AbsoluteDate date)
Propagate towards a target date.
|
SpacecraftState |
EpochDerivativesEquations.setInitialJacobians(SpacecraftState s0)
Set the initial value of the Jacobian with respect to state and parameter.
|
SpacecraftState |
EpochDerivativesEquations.setInitialJacobians(SpacecraftState s1,
double[][] dY1dY0,
double[][] dY1dP)
Set the initial value of the Jacobian with respect to state and parameter.
|
| Modifier and Type | Method and Description |
|---|---|
protected void |
NumericalPropagator.beforeIntegration(SpacecraftState initialState,
AbsoluteDate tEnd)
Method called just before integration.
|
CombinedDerivatives |
EpochDerivativesEquations.combinedDerivatives(SpacecraftState s)
Compute the derivatives related to the additional state (and optionally main state increments).
|
void |
NumericalPropagator.resetInitialState(SpacecraftState state)
Reset the propagator initial state.
|
SpacecraftState |
EpochDerivativesEquations.setInitialJacobians(SpacecraftState s0)
Set the initial value of the Jacobian with respect to state and parameter.
|
SpacecraftState |
EpochDerivativesEquations.setInitialJacobians(SpacecraftState s1,
double[][] dY1dY0,
double[][] dY1dP)
Set the initial value of the Jacobian with respect to state and parameter.
|
void |
EpochDerivativesEquations.setInitialJacobians(SpacecraftState state,
double[][] dY1dY0,
double[][] dY1dP,
double[] p)
Set the Jacobian with respect to state into a one-dimensional additional state array.
|
void |
NumericalPropagator.setInitialState(SpacecraftState initialState)
Set the initial state.
|
| Modifier and Type | Method and Description |
|---|---|
protected SpacecraftState |
CR3BPMultipleShooter.getAugmentedInitialState(int i)
Compute the additional state from the additionalEquations.
|
SpacecraftState |
STMEquations.setInitialPhi(SpacecraftState s)
Method adding the standard initial values of the additional state to the initial spacecraft state.
|
| Modifier and Type | Method and Description |
|---|---|
org.hipparchus.geometry.euclidean.threed.Vector3D |
CR3BPForceModel.acceleration(SpacecraftState s,
double[] parameters)
Compute acceleration.
|
CombinedDerivatives |
STMEquations.combinedDerivatives(SpacecraftState s)
Compute the derivatives related to the additional state (and optionally main state increments).
|
org.hipparchus.analysis.differentiation.DerivativeStructure |
CR3BPForceModel.getPotential(SpacecraftState s)
Calculate spacecraft potential.
|
org.hipparchus.linear.RealMatrix |
STMEquations.getStateTransitionMatrix(SpacecraftState s)
Method returning the State Transition Matrix.
|
SpacecraftState |
STMEquations.setInitialPhi(SpacecraftState s)
Method adding the standard initial values of the additional state to the initial spacecraft state.
|
| Modifier and Type | Method and Description |
|---|---|
protected double[] |
CR3BPMultipleShooter.computeAdditionalConstraints(List<SpacecraftState> propagatedSP)
Compute the additional constraints.
|
protected double[][] |
CR3BPMultipleShooter.computeAdditionalJacobianMatrix(List<SpacecraftState> propagatedSP)
Compute a part of the Jacobian matrix from additional constraints.
|
| Constructor and Description |
|---|
CR3BPMultipleShooter(List<SpacecraftState> initialGuessList,
List<NumericalPropagator> propagatorList,
List<STMEquations> stmEquations,
double tolerance,
int maxIter)
Simple Constructor.
|
| Modifier and Type | Method and Description |
|---|---|
SpacecraftState |
OrekitStepInterpolator.getCurrentState()
Get the state at current grid point date.
|
SpacecraftState |
OrekitStepInterpolator.getInterpolatedState(AbsoluteDate date)
Get the state at interpolated date.
|
SpacecraftState |
OrekitStepInterpolator.getPreviousState()
Get the state at previous grid point date.
|
| Modifier and Type | Method and Description |
|---|---|
void |
OrekitStepNormalizer.finish(SpacecraftState finalState)
Finalize propagation.
|
default void |
OrekitStepHandler.finish(SpacecraftState finalState)
Finalize propagation.
|
void |
StepHandlerMultiplexer.finish(SpacecraftState finalState)
Finalize propagation.
|
default void |
OrekitFixedStepHandler.finish(SpacecraftState finalState)
Finalize propagation.
|
void |
OrekitFixedStepHandler.handleStep(SpacecraftState currentState)
Handle the current step.
|
void |
OrekitStepNormalizer.init(SpacecraftState s0,
AbsoluteDate t)
Initialize step handler at the start of a propagation.
|
default void |
OrekitStepHandler.init(SpacecraftState s0,
AbsoluteDate t)
Initialize step handler at the start of a propagation.
|
void |
StepHandlerMultiplexer.init(SpacecraftState s0,
AbsoluteDate t)
Initialize step handler at the start of a propagation.
|
default void |
OrekitFixedStepHandler.init(SpacecraftState s0,
AbsoluteDate t,
double step)
Initialize step handler at the start of a propagation.
|
OrekitStepInterpolator |
OrekitStepInterpolator.restrictStep(SpacecraftState newPreviousState,
SpacecraftState newCurrentState)
Create a new restricted version of the instance.
|
| Modifier and Type | Method and Description |
|---|---|
void |
MultisatStepNormalizer.finish(List<SpacecraftState> finalStates)
Finalize propagation.
|
default void |
MultiSatFixedStepHandler.finish(List<SpacecraftState> finalStates)
Finalize propagation.
|
default void |
MultiSatStepHandler.finish(List<SpacecraftState> finalStates)
Finalize propagation.
|
void |
MultiSatFixedStepHandler.handleStep(List<SpacecraftState> states)
Handle the current step.
|
void |
MultisatStepNormalizer.init(List<SpacecraftState> s0,
AbsoluteDate t)
Initialize step handler at the start of a propagation.
|
default void |
MultiSatStepHandler.init(List<SpacecraftState> states0,
AbsoluteDate t)
Initialize step handler at the start of a propagation.
|
default void |
MultiSatFixedStepHandler.init(List<SpacecraftState> states0,
AbsoluteDate t,
double step)
Initialize step handler at the start of a propagation.
|
| Modifier and Type | Method and Description |
|---|---|
static SpacecraftState |
DSSTPropagator.computeMeanState(SpacecraftState osculating,
AttitudeProvider attitudeProvider,
Collection<DSSTForceModel> forceModels)
Conversion from osculating to mean orbit.
|
static SpacecraftState |
DSSTPropagator.computeMeanState(SpacecraftState osculating,
AttitudeProvider attitudeProvider,
Collection<DSSTForceModel> forceModels,
double epsilon,
int maxIterations)
Conversion from osculating to mean orbit.
|
static SpacecraftState |
DSSTPropagator.computeOsculatingState(SpacecraftState mean,
AttitudeProvider attitudeProvider,
Collection<DSSTForceModel> forces)
Conversion from mean to osculating orbit.
|
protected SpacecraftState |
DSSTPropagator.getInitialIntegrationState()
Get the initial state for integration.
|
| Modifier and Type | Method and Description |
|---|---|
protected void |
DSSTPropagator.beforeIntegration(SpacecraftState initialState,
AbsoluteDate tEnd)
Method called just before integration.
|
static SpacecraftState |
DSSTPropagator.computeMeanState(SpacecraftState osculating,
AttitudeProvider attitudeProvider,
Collection<DSSTForceModel> forceModels)
Conversion from osculating to mean orbit.
|
static SpacecraftState |
DSSTPropagator.computeMeanState(SpacecraftState osculating,
AttitudeProvider attitudeProvider,
Collection<DSSTForceModel> forceModels,
double epsilon,
int maxIterations)
Conversion from osculating to mean orbit.
|
static SpacecraftState |
DSSTPropagator.computeOsculatingState(SpacecraftState mean,
AttitudeProvider attitudeProvider,
Collection<DSSTForceModel> forces)
Conversion from mean to osculating orbit.
|
org.hipparchus.linear.RealMatrix |
DSSTHarvester.getB2(SpacecraftState state)
Get the Jacobian matrix B2 (B2 = ∂Y/∂Y₀).
|
org.hipparchus.linear.RealMatrix |
DSSTHarvester.getB3(SpacecraftState state)
Get the Jacobian matrix B3 (B3 = ∂Y/∂P).
|
org.hipparchus.linear.RealMatrix |
DSSTHarvester.getParametersJacobian(SpacecraftState state)
Get the Jacobian with respect to propagation parameters.
|
double[] |
DSSTPropagator.getShortPeriodTermsValue(SpacecraftState meanState)
Get the short period terms value.
|
org.hipparchus.linear.RealMatrix |
DSSTHarvester.getStateTransitionMatrix(SpacecraftState state)
Extract state transition matrix from state.
|
void |
DSSTHarvester.initializeFieldShortPeriodTerms(SpacecraftState reference)
Initialize the short periodic terms for the "field" elements.
|
void |
DSSTPropagator.resetInitialState(SpacecraftState state)
Reset the initial state.
|
void |
DSSTPropagator.setInitialState(SpacecraftState initialState)
Set the initial state with osculating orbital elements.
|
void |
DSSTPropagator.setInitialState(SpacecraftState initialState,
PropagationType stateType)
Set the initial state.
|
void |
DSSTHarvester.setReferenceState(SpacecraftState reference)
Set up reference state.
|
void |
DSSTHarvester.updateFieldShortPeriodTerms(SpacecraftState reference)
Update the short periodic terms for the "field" elements.
|
| Modifier and Type | Method and Description |
|---|---|
AbstractGaussianContribution.Slot |
AbstractGaussianContribution.GaussianShortPeriodicCoefficients.createSlot(SpacecraftState... meanStates)
Get the slot valid for some date.
|
protected abstract double[] |
AbstractGaussianContribution.getLLimits(SpacecraftState state,
AuxiliaryElements auxiliaryElements)
Compute the limits in L, the true longitude, for integration.
|
protected double[] |
DSSTSolarRadiationPressure.getLLimits(SpacecraftState state,
AuxiliaryElements auxiliaryElements)
Compute the limits in L, the true longitude, for integration.
|
protected double[] |
DSSTAtmosphericDrag.getLLimits(SpacecraftState state,
AuxiliaryElements auxiliaryElements)
Compute the limits in L, the true longitude, for integration.
|
protected double[] |
AbstractGaussianContribution.getMeanElementRate(SpacecraftState state,
AbstractGaussianContribution.GaussQuadrature gauss,
double low,
double high,
AbstractGaussianContributionContext context,
double[] parameters)
Computes the mean equinoctial elements rates dai / dt.
|
double[] |
DSSTZonal.getMeanElementRate(SpacecraftState spacecraftState,
AuxiliaryElements auxiliaryElements,
double[] parameters)
Computes the mean equinoctial elements rates dai / dt.
|
double[] |
DSSTForceModel.getMeanElementRate(SpacecraftState state,
AuxiliaryElements auxiliaryElements,
double[] parameters)
Computes the mean equinoctial elements rates dai / dt.
|
double[] |
DSSTTesseral.getMeanElementRate(SpacecraftState spacecraftState,
AuxiliaryElements auxiliaryElements,
double[] parameters)
Computes the mean equinoctial elements rates dai / dt.
|
double[] |
DSSTJ2SquaredClosedForm.getMeanElementRate(SpacecraftState state,
AuxiliaryElements auxiliaryElements,
double[] parameters)
Computes the mean equinoctial elements rates dai / dt.
|
double[] |
AbstractGaussianContribution.getMeanElementRate(SpacecraftState state,
AuxiliaryElements auxiliaryElements,
double[] parameters)
Computes the mean equinoctial elements rates dai / dt.
|
double[] |
DSSTThirdBody.getMeanElementRate(SpacecraftState currentState,
AuxiliaryElements auxiliaryElements,
double[] parameters)
Computes the mean equinoctial elements rates dai / dt.
|
double[] |
DSSTNewtonianAttraction.getMeanElementRate(SpacecraftState state,
AuxiliaryElements auxiliaryElements,
double[] parameters)
Computes the mean equinoctial elements rates dai / dt.
|
default void |
DSSTForceModel.init(SpacecraftState initialState,
AbsoluteDate target)
Initialize the force model at the start of propagation.
|
void |
AbstractGaussianContribution.init(SpacecraftState initialState,
AbsoluteDate target)
Initialize the force model at the start of propagation.
|
void |
DSSTZonal.updateShortPeriodTerms(double[] parameters,
SpacecraftState... meanStates)
Update the short period terms.
|
void |
DSSTForceModel.updateShortPeriodTerms(double[] parameters,
SpacecraftState... meanStates)
Update the short period terms.
|
void |
DSSTTesseral.updateShortPeriodTerms(double[] parameters,
SpacecraftState... meanStates)
Update the short period terms.
|
void |
DSSTJ2SquaredClosedForm.updateShortPeriodTerms(double[] parameters,
SpacecraftState... meanStates)
Update the short period terms.
|
void |
AbstractGaussianContribution.updateShortPeriodTerms(double[] parameters,
SpacecraftState... meanStates)
Update the short period terms.
|
void |
DSSTThirdBody.updateShortPeriodTerms(double[] parameters,
SpacecraftState... meanStates)
Update the short period terms.
|
void |
DSSTNewtonianAttraction.updateShortPeriodTerms(double[] parameters,
SpacecraftState... meanStates)
Update the short period terms.
|
| Modifier and Type | Method and Description |
|---|---|
protected SpacecraftState |
MultipleShooter.getAugmentedInitialState(int i)
Compute the additional state from the additionalEquations.
|
protected abstract SpacecraftState |
AbstractMultipleShooting.getAugmentedInitialState(int i)
Compute the additional state from the additionalEquations.
|
protected SpacecraftState |
AbstractMultipleShooting.getPatchPoint(int i)
Get a patch point.
|
| Modifier and Type | Method and Description |
|---|---|
List<SpacecraftState> |
AbstractMultipleShooting.compute()
Return the list of corrected patch points.
|
List<SpacecraftState> |
MultipleShooting.compute()
Return the list of corrected patch points.
|
protected List<SpacecraftState> |
AbstractMultipleShooting.getPatchedSpacecraftState()
Get the list of patched spacecraft states.
|
| Modifier and Type | Method and Description |
|---|---|
OccultationEngine.OccultationAngles |
OccultationEngine.angles(SpacecraftState state)
Compute the occultation angles as seen from a spacecraft.
|
double[] |
StateFunction.value(SpacecraftState state)
Evaluate the function.
|
double[][] |
StateJacobian.value(SpacecraftState state)
Evaluate the Jacobian of the function.
|
| Modifier and Type | Method and Description |
|---|---|
protected double[] |
MultipleShooter.computeAdditionalConstraints(List<SpacecraftState> propagatedSP)
Compute the additional constraints.
|
protected abstract double[] |
AbstractMultipleShooting.computeAdditionalConstraints(List<SpacecraftState> propagatedSP)
Compute the additional constraints.
|
protected double[][] |
MultipleShooter.computeAdditionalJacobianMatrix(List<SpacecraftState> propagatedSP)
Compute a part of the Jacobian matrix from additional constraints.
|
protected abstract double[][] |
AbstractMultipleShooting.computeAdditionalJacobianMatrix(List<SpacecraftState> propagatedSP)
Compute a part of the Jacobian matrix from additional constraints.
|
protected double[][] |
AbstractMultipleShooting.computeEpochJacobianMatrix(List<SpacecraftState> propagatedSP)
Compute a part of the Jacobian matrix with derivatives from epoch.
|
| Constructor and Description |
|---|
AbstractMultipleShooting(List<SpacecraftState> initialGuessList,
List<NumericalPropagator> propagatorList,
double tolerance,
int maxIter,
boolean isAutonomous,
String additionalName)
Simple Constructor.
|
MultipleShooter(List<SpacecraftState> initialGuessList,
List<NumericalPropagator> propagatorList,
List<EpochDerivativesEquations> epochEquations,
double tolerance,
int maxIter)
Simple Constructor.
|
Copyright © 2002-2023 CS GROUP. All rights reserved.