Uses of Class
org.orekit.propagation.SpacecraftState
-
Packages that use SpacecraftState Package Description org.orekit.attitudes This package provides classes to represent simple attitudes.org.orekit.control.indirect.adjoint This package provides routines to model the adjoint dynamics as in the Pontryagin Maximum Principle, as used in indirect control.org.orekit.control.indirect.shooting This package provides routines to solve indirect optimal control within the frame of orbital mechanics, using shooting methods.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.generation This package provides Orbit Determination measurements generation.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 theNumericalPropagator
, 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 classManeuver
.org.orekit.forces.maneuvers.trigger This package provides maneuver triggers' models intended to be used with classManeuver
.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 Propagationorg.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.intelsat This package provides classes to propagate Intelsat's 11 elements.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 ofSpacecraftState
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. -
-
Uses of SpacecraftState in org.orekit.attitudes
Methods in org.orekit.attitudes that return SpacecraftState Modifier and Type Method Description SpacecraftState
AttitudesSequence.Switch. resetState(EventDetector detector, SpacecraftState oldState)
Reset the state prior to continue propagation.Methods in org.orekit.attitudes with parameters of type SpacecraftState Modifier and Type Method Description Action
AttitudesSequence.Switch. eventOccurred(SpacecraftState s, EventDetector detector, boolean increasing)
Handle an event.double
AttitudesSequence.Switch. g(SpacecraftState s)
Compute the value of the switching function.void
AttitudesSequence.Switch. init(SpacecraftState s0, AbsoluteDate t)
Initialize event handler at the start of a propagation.SpacecraftState
AttitudesSequence.Switch. resetState(EventDetector detector, SpacecraftState oldState)
Reset the state prior to continue propagation.void
AttitudesSequence.SwitchHandler. switchOccurred(AttitudeProvider preceding, AttitudeProvider following, SpacecraftState state)
Method called when attitude is switched from one law to another law. -
Uses of SpacecraftState in org.orekit.control.indirect.adjoint
Methods in org.orekit.control.indirect.adjoint with parameters of type SpacecraftState Modifier and Type Method Description CombinedDerivatives
CartesianAdjointDerivativesProvider. combinedDerivatives(SpacecraftState state)
Compute the derivatives related to the additional state (and optionally main state increments).double
CartesianAdjointDerivativesProvider. evaluateHamiltonian(SpacecraftState state)
Evaluate the Hamiltonian from Pontryagin's Maximum Principle.void
CartesianAdjointDerivativesProvider. init(SpacecraftState initialState, AbsoluteDate target)
Initialize the generator at the start of propagation. -
Uses of SpacecraftState in org.orekit.control.indirect.shooting
Methods in org.orekit.control.indirect.shooting that return SpacecraftState Modifier and Type Method Description protected SpacecraftState
AbstractFixedBoundaryCartesianSingleShooting. createStateWithMassAndAdjoint(double initialMass, double[] initialAdjoint)
Create initial state with input mass and adjoint vector.SpacecraftState
ShootingBoundaryOutput. getInitialState()
Getter for the initial state.SpacecraftState
ShootingBoundaryOutput. getTerminalState()
Getter for the terminal state.Methods in org.orekit.control.indirect.shooting with parameters of type SpacecraftState Modifier and Type Method Description protected NumericalPropagator
AbstractFixedBoundaryCartesianSingleShooting. buildPropagator(SpacecraftState initialState)
Create numerical propagator.protected NumericalPropagator
AbstractIndirectShooting. buildPropagator(SpacecraftState initialState)
Create numerical propagator.Constructors in org.orekit.control.indirect.shooting with parameters of type SpacecraftState Constructor Description ShootingBoundaryOutput(boolean converged, int iterationCount, SpacecraftState initialState, ShootingPropagationSettings shootingPropagationSettings, SpacecraftState terminalState)
Constructor. -
Uses of SpacecraftState in org.orekit.estimation.measurements
Methods in org.orekit.estimation.measurements that return SpacecraftState Modifier and Type Method Description SpacecraftState
CommonParametersWithDerivatives. getState()
Get spacecraft state.SpacecraftState
CommonParametersWithoutDerivatives. getState()
Get spacecraft state.SpacecraftState[]
EstimatedMeasurementBase. getStates()
Get the states of the spacecrafts.SpacecraftState
CommonParametersWithDerivatives. getTransitState()
Get transit state.SpacecraftState
CommonParametersWithoutDerivatives. getTransitState()
Get transit state.Methods in org.orekit.estimation.measurements with parameters of type SpacecraftState Modifier and Type Method Description protected GroundReceiverCommonParametersWithDerivatives
GroundReceiverMeasurement. computeCommonParametersWithDerivatives(SpacecraftState state)
Compute common estimation parameters.protected GroundReceiverCommonParametersWithoutDerivatives
GroundReceiverMeasurement. computeCommonParametersWithout(SpacecraftState state)
Compute common estimation parameters.EstimatedMeasurement<T>
AbstractMeasurement. estimate(int iteration, int evaluation, SpacecraftState[] states)
Estimate the theoretical value of the measurement, with derivatives.EstimatedMeasurement<T>
ObservedMeasurement. estimate(int iteration, int evaluation, SpacecraftState[] states)
Estimate the theoretical value of the measurement, with derivatives.EstimatedMeasurementBase<T>
AbstractMeasurement. estimateWithoutDerivatives(int iteration, int evaluation, SpacecraftState[] states)
Estimate the theoretical value of the measurement, without derivatives.EstimatedMeasurementBase<T>
ObservedMeasurement. estimateWithoutDerivatives(int iteration, int evaluation, SpacecraftState[] states)
Estimate the theoretical value of the measurement, without derivatives.default EstimatedMeasurementBase<T>
ObservedMeasurement. estimateWithoutDerivatives(SpacecraftState[] states)
Estimate the theoretical value of the measurement, without derivatives.static TimeStampedFieldPVCoordinates<Gradient>
AbstractMeasurement. getCoordinates(SpacecraftState state, int firstDerivative, int freeParameters)
Get Cartesian coordinates as derivatives.protected abstract EstimatedMeasurement<T>
AbstractMeasurement. 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<AngularRaDec>
AngularRaDec. 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<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<InterSatellitesRange>
InterSatellitesRange. 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<Position>
Position. 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<Range>
Range. 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<TDOA>
TDOA. theoreticalEvaluation(int iteration, int evaluation, SpacecraftState[] states)
Estimate the theoretical value.protected EstimatedMeasurement<TurnAroundRange>
TurnAroundRange. theoreticalEvaluation(int iteration, int evaluation, SpacecraftState[] states)
Estimate the theoretical value.protected abstract EstimatedMeasurementBase<T>
AbstractMeasurement. 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<AngularRaDec>
AngularRaDec. 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<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<InterSatellitesRange>
InterSatellitesRange. 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<Position>
Position. 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<Range>
Range. 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<TDOA>
TDOA. theoreticalEvaluationWithoutDerivatives(int iteration, int evaluation, SpacecraftState[] states)
Estimate the theoretical value without derivatives.protected EstimatedMeasurementBase<TurnAroundRange>
TurnAroundRange. theoreticalEvaluationWithoutDerivatives(int iteration, int evaluation, SpacecraftState[] states)
Estimate the theoretical value without derivatives. -
Uses of SpacecraftState in org.orekit.estimation.measurements.filtering
Methods in org.orekit.estimation.measurements.filtering with parameters of type SpacecraftState Modifier and Type Method Description void
ElevationFilter. filter(ObservedMeasurement<T> measurement, SpacecraftState state)
Apply a filter to an observed measurement.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. -
Uses of SpacecraftState in org.orekit.estimation.measurements.generation
Methods in org.orekit.estimation.measurements.generation with parameters of type SpacecraftState Modifier and Type Method Description default T
MeasurementBuilder. build(AbsoluteDate date, SpacecraftState[] states)
Generate a single measurement. -
Uses of SpacecraftState in org.orekit.estimation.measurements.gnss
Methods in org.orekit.estimation.measurements.gnss with parameters of type SpacecraftState Modifier and Type Method Description protected OnBoardCommonParametersWithDerivatives
AbstractOnBoardMeasurement. computeCommonParametersWith(SpacecraftState[] states, boolean clockOffsetAlreadyApplied)
Compute common estimation parameters.protected OnBoardCommonParametersWithoutDerivatives
AbstractOnBoardMeasurement. computeCommonParametersWithout(SpacecraftState[] states, boolean clockOffsetAlreadyApplied)
Compute common estimation parameters.protected PVCoordinatesProvider
AbstractInterSatellitesMeasurement. getRemotePV(SpacecraftState[] states)
Get emitting satellite position/velocity provider.protected FieldPVCoordinatesProvider<Gradient>
AbstractInterSatellitesMeasurement. getRemotePV(SpacecraftState[] states, int freeParameters)
Get emitting satellite position/velocity provider.protected abstract PVCoordinatesProvider
AbstractOnBoardMeasurement. getRemotePV(SpacecraftState[] states)
Get emitting satellite position/velocity provider.protected abstract FieldPVCoordinatesProvider<Gradient>
AbstractOnBoardMeasurement. getRemotePV(SpacecraftState[] states, int freeParameters)
Get emitting satellite position/velocity provider.protected PVCoordinatesProvider
AbstractOneWayGNSSMeasurement. getRemotePV(SpacecraftState[] states)
Get emitting satellite position/velocity provider.protected FieldPVCoordinatesProvider<Gradient>
AbstractOneWayGNSSMeasurement. getRemotePV(SpacecraftState[] states, int freeParameters)
Get emitting satellite position/velocity provider.protected EstimatedMeasurement<InterSatellitesOneWayRangeRate>
InterSatellitesOneWayRangeRate. 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 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<OneWayGNSSRangeRate>
OneWayGNSSRangeRate. theoreticalEvaluation(int iteration, int evaluation, SpacecraftState[] states)
Estimate the theoretical value.protected EstimatedMeasurement<Phase>
Phase. theoreticalEvaluation(int iteration, int evaluation, SpacecraftState[] states)
Estimate the theoretical value.protected EstimatedMeasurementBase<InterSatellitesOneWayRangeRate>
InterSatellitesOneWayRangeRate. 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.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<OneWayGNSSRangeRate>
OneWayGNSSRangeRate. theoreticalEvaluationWithoutDerivatives(int iteration, int evaluation, SpacecraftState[] states)
Estimate the theoretical value without derivatives.protected EstimatedMeasurementBase<Phase>
Phase. theoreticalEvaluationWithoutDerivatives(int iteration, int evaluation, SpacecraftState[] states)
Estimate the theoretical value without derivatives.Constructors in org.orekit.estimation.measurements.gnss with parameters of type SpacecraftState Constructor Description OnBoardCommonParametersWithDerivatives(SpacecraftState localState, Map<String,Integer> indices, Gradient localOffset, Gradient localRate, Gradient remoteOffset, Gradient remoteRate, Gradient tauD, TimeStampedFieldPVCoordinates<Gradient> localPV, TimeStampedFieldPVCoordinates<Gradient> remotePV)
Simple constructor.OnBoardCommonParametersWithoutDerivatives(SpacecraftState localState, double localOffset, double localRate, double remoteOffset, double remoteRate, double tauD, TimeStampedPVCoordinates localPV, TimeStampedPVCoordinates remotePV)
Simple constructor. -
Uses of SpacecraftState in org.orekit.estimation.measurements.modifiers
Methods in org.orekit.estimation.measurements.modifiers with parameters of type SpacecraftState Modifier and Type Method Description double
ParametricModelEffect. evaluate(GroundStation station, SpacecraftState state)
Evaluate the parametric model effect.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
BaseRangeRateTroposphericDelayModifier. rangeRateErrorTroposphericModel(GroundStation station, SpacecraftState state)
Compute the measurement error due to Troposphere.double
RangeRateTroposphericDelayModifier. rangeRateErrorTroposphericModel(GroundStation station, SpacecraftState state)
Compute the measurement error due to Troposphere.Constructors in org.orekit.estimation.measurements.modifiers with parameters of type SpacecraftState Constructor Description ModifierGradientConverter(SpacecraftState state, int freeStateParameters, AttitudeProvider provider)
Simple constructor. -
Uses of SpacecraftState in org.orekit.estimation.sequential
Methods in org.orekit.estimation.sequential that return SpacecraftState Modifier and Type Method Description static SpacecraftState[]
KalmanEstimatorUtil. filterRelevant(ObservedMeasurement<?> observedMeasurement, SpacecraftState[] allStates)
Filter relevant states for a measurement.SpacecraftState[]
KalmanEstimation. getCorrectedSpacecraftStates()
Get the corrected spacecraft states.SpacecraftState[]
SemiAnalyticalKalmanModel. getCorrectedSpacecraftStates()
Get the corrected spacecraft states.SpacecraftState[]
SemiAnalyticalUnscentedKalmanModel. getCorrectedSpacecraftStates()
Get the corrected spacecraft states.SpacecraftState[]
KalmanEstimation. getPredictedSpacecraftStates()
Get the predicted spacecraft states.SpacecraftState[]
SemiAnalyticalKalmanModel. getPredictedSpacecraftStates()
Get the predicted spacecraft states.SpacecraftState[]
SemiAnalyticalUnscentedKalmanModel. getPredictedSpacecraftStates()
Get the predicted spacecraft states.Methods in org.orekit.estimation.sequential with parameters of type SpacecraftState Modifier and Type Method Description static SpacecraftState[]
KalmanEstimatorUtil. filterRelevant(ObservedMeasurement<?> observedMeasurement, SpacecraftState[] allStates)
Filter relevant states for a measurement.RealMatrix
AbstractCovarianceMatrixProvider. getInitialCovarianceMatrix(SpacecraftState initial)
Get the initial covariance matrix.RealMatrix
CovarianceMatrixProvider. getInitialCovarianceMatrix(SpacecraftState initial)
Get the initial covariance matrix.RealMatrix
ConstantProcessNoise. getProcessNoiseMatrix(SpacecraftState previous, SpacecraftState current)
Get the process noise matrix between previous and current states.RealMatrix
CovarianceMatrixProvider. getProcessNoiseMatrix(SpacecraftState previous, SpacecraftState current)
Get the process noise matrix between previous and current states.RealMatrix
UnivariateProcessNoise. 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
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. initializeShortPeriodicTerms(SpacecraftState meanState)
Initialize the short periodic terms for the Kalman Filter.void
SemiAnalyticalKalmanModel. updateNominalSpacecraftState(SpacecraftState nominal)
Update the nominal spacecraft state.void
SemiAnalyticalProcess. updateNominalSpacecraftState(SpacecraftState nominal)
Update the nominal spacecraft state.void
SemiAnalyticalUnscentedKalmanModel. updateNominalSpacecraftState(SpacecraftState nominal)
Update the nominal spacecraft state.void
SemiAnalyticalKalmanModel. updateShortPeriods(SpacecraftState state)
Update the DSST short periodic terms.void
SemiAnalyticalProcess. updateShortPeriods(SpacecraftState state)
Update the DSST short periodic terms.void
SemiAnalyticalUnscentedKalmanModel. updateShortPeriods(SpacecraftState state)
Update the DSST short periodic terms. -
Uses of SpacecraftState in org.orekit.files.ccsds.ndm.adm.aem
Methods in org.orekit.files.ccsds.ndm.adm.aem with parameters of type SpacecraftState Modifier and Type Method 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. -
Uses of SpacecraftState in org.orekit.files.ccsds.ndm.odm.ocm
Methods in org.orekit.files.ccsds.ndm.odm.ocm with parameters of type SpacecraftState Modifier and Type Method 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. -
Uses of SpacecraftState in org.orekit.files.ccsds.ndm.odm.oem
Methods in org.orekit.files.ccsds.ndm.odm.oem with parameters of type SpacecraftState Modifier and Type Method 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. -
Uses of SpacecraftState in org.orekit.files.ccsds.ndm.odm.omm
Methods in org.orekit.files.ccsds.ndm.odm.omm that return SpacecraftState Modifier and Type Method Description SpacecraftState
Omm. generateSpacecraftState()
Generate spacecraft state from theCartesianOrbit
generated by generateCartesianOrbit. -
Uses of SpacecraftState in org.orekit.files.ccsds.ndm.odm.opm
Methods in org.orekit.files.ccsds.ndm.odm.opm that return SpacecraftState Modifier and Type Method Description SpacecraftState
Opm. generateSpacecraftState()
Generate spacecraft state from theCartesianOrbit
generated by generateCartesianOrbit. -
Uses of SpacecraftState in org.orekit.files.general
Methods in org.orekit.files.general that return SpacecraftState Modifier and Type Method Description SpacecraftState
EphemerisSegmentPropagator. getInitialState()
Methods in org.orekit.files.general with parameters of type SpacecraftState Modifier and Type Method Description void
EphemerisSegmentPropagator. resetInitialState(SpacecraftState state)
protected void
EphemerisSegmentPropagator. resetIntermediateState(SpacecraftState state, boolean forward)
Method parameters in org.orekit.files.general with type arguments of type SpacecraftState Modifier and Type Method Description 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 generatedOrekitAttitudeEphemerisFile.OrekitAttitudeEphemerisSegment
that has been stored internally.OrekitEphemerisFile.OrekitEphemerisSegment
OrekitEphemerisFile.OrekitSatelliteEphemeris. addNewSegment(List<SpacecraftState> states)
Injects pre-computed satellite states into this ephemeris file object, returning the generatedOrekitEphemerisFile.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 generatedOrekitEphemerisFile.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 generatedOrekitEphemerisFile.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 generatedOrekitEphemerisFile.OrekitEphemerisSegment
that has been stored internally. -
Uses of SpacecraftState in org.orekit.files.ilrs
Methods in org.orekit.files.ilrs with parameters of type SpacecraftState Modifier and Type Method Description void
StreamingCpfWriter.Segment. finish(SpacecraftState finalState)
Finalize propagation.void
StreamingCpfWriter.Segment. handleStep(SpacecraftState currentState)
Handle the current step. -
Uses of SpacecraftState in org.orekit.forces
Methods in org.orekit.forces with parameters of type SpacecraftState Modifier and Type Method Description 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.Vector3D
BoxAndSolarArraySpacecraft. dragAcceleration(SpacecraftState state, double density, Vector3D relativeVelocity, double[] parameters)
Compute the acceleration due to drag.Vector3D
FixedPanel. getNormal(SpacecraftState state)
Get panel normal in spacecraft frame.abstract Vector3D
Panel. getNormal(SpacecraftState state)
Get panel normal in spacecraft frame.Vector3D
PointingPanel. getNormal(SpacecraftState state)
Get panel normal in spacecraft frame.Vector3D
SlewingPanel. 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.Vector3D
BoxAndSolarArraySpacecraft. radiationPressureAcceleration(SpacecraftState state, Vector3D flux, double[] parameters)
Compute the acceleration due to radiation pressure. -
Uses of SpacecraftState in org.orekit.forces.drag
Methods in org.orekit.forces.drag with parameters of type SpacecraftState Modifier and Type Method Description Vector3D
DragForce. acceleration(SpacecraftState s, double[] parameters)
Compute acceleration.Vector3D
TimeSpanDragForce. acceleration(SpacecraftState s, double[] parameters)
Deprecated.Compute acceleration.Vector3D
DragSensitive. dragAcceleration(SpacecraftState state, double density, Vector3D relativeVelocity, double[] parameters)
Compute the acceleration due to drag.Vector3D
IsotropicDrag. dragAcceleration(SpacecraftState state, double density, Vector3D relativeVelocity, double[] parameters)
Compute the acceleration due to drag. -
Uses of SpacecraftState in org.orekit.forces.empirical
Methods in org.orekit.forces.empirical with parameters of type SpacecraftState Modifier and Type Method Description Vector3D
ParametricAcceleration. acceleration(SpacecraftState state, double[] parameters)
Compute acceleration.Vector3D
TimeSpanParametricAcceleration. acceleration(SpacecraftState state, double[] parameters)
Compute acceleration.default void
AccelerationModel. init(SpacecraftState initialState, AbsoluteDate target)
Initialize the acceleration model at the start of the propagation.void
HarmonicAccelerationModel. 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
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.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.double
PolynomialAccelerationModel. signedAmplitude(SpacecraftState state, double[] parameters)
Compute the signed amplitude of the acceleration. -
Uses of SpacecraftState in org.orekit.forces.gravity
Methods in org.orekit.forces.gravity with parameters of type SpacecraftState Modifier and Type Method Description Vector3D
DeSitterRelativity. acceleration(SpacecraftState s, double[] parameters)
Compute acceleration.Vector3D
HolmesFeatherstoneAttractionModel. acceleration(SpacecraftState s, double[] parameters)
Compute acceleration.Vector3D
J2OnlyPerturbation. acceleration(SpacecraftState state, double[] parameters)
Compute acceleration.Vector3D
LenseThirringRelativity. acceleration(SpacecraftState s, double[] parameters)
Compute acceleration.Vector3D
NewtonianAttraction. acceleration(SpacecraftState s, double[] parameters)
Compute acceleration.Vector3D
OceanTides. acceleration(SpacecraftState s, double[] parameters)
Compute acceleration.Vector3D
Relativity. acceleration(SpacecraftState s, double[] parameters)
Compute acceleration.Vector3D
SingleBodyAbsoluteAttraction. acceleration(SpacecraftState s, double[] parameters)
Compute acceleration.Vector3D
SingleBodyRelativeAttraction. acceleration(SpacecraftState s, double[] parameters)
Compute acceleration.Vector3D
SolidTides. acceleration(SpacecraftState s, double[] parameters)
Compute acceleration.Vector3D
ThirdBodyAttraction. 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. -
Uses of SpacecraftState in org.orekit.forces.inertia
Methods in org.orekit.forces.inertia with parameters of type SpacecraftState Modifier and Type Method Description Vector3D
InertialForces. acceleration(SpacecraftState s, double[] parameters)
Compute acceleration. -
Uses of SpacecraftState in org.orekit.forces.maneuvers
Methods in org.orekit.forces.maneuvers that return SpacecraftState Modifier and Type Method Description SpacecraftState
SmallManeuverAnalyticalModel. apply(SpacecraftState state1)
Compute the effect of the maneuver on a spacecraft state.Methods in org.orekit.forces.maneuvers with parameters of type SpacecraftState Modifier and Type Method Description 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
ImpulseManeuver. init(SpacecraftState s0, AbsoluteDate t)
Initialize event handler at the start of a propagation.void
Maneuver. init(SpacecraftState initialState, AbsoluteDate target)
Initialize the force model at the start of propagation.boolean
ConstantThrustManeuver. isFiring(SpacecraftState s)
Check if maneuvering is on.Constructors in org.orekit.forces.maneuvers with parameters of type SpacecraftState Constructor Description SmallManeuverAnalyticalModel(SpacecraftState state0, Vector3D dV, double isp)
Build a maneuver defined in spacecraft frame with default orbit type.SmallManeuverAnalyticalModel(SpacecraftState state0, Frame frame, Vector3D dV, double isp)
Build a maneuver defined in user-specified frame.SmallManeuverAnalyticalModel(SpacecraftState state0, OrbitType orbitType, Vector3D dV, double isp)
Build a maneuver defined in spacecraft frame.SmallManeuverAnalyticalModel(SpacecraftState state0, OrbitType orbitType, Frame frame, Vector3D dV, double isp)
Build a maneuver defined in user-specified frame. -
Uses of SpacecraftState in org.orekit.forces.maneuvers.jacobians
Methods in org.orekit.forces.maneuvers.jacobians that return SpacecraftState Modifier and Type Method Description SpacecraftState
TriggerDate. resetState(SpacecraftState state)
Reset state as a maneuver triggers.Methods in org.orekit.forces.maneuvers.jacobians with parameters of type SpacecraftState Modifier and Type Method Description CombinedDerivatives
MassDepletionDelay. combinedDerivatives(SpacecraftState state)
Compute the derivatives related to the additional state (and optionally main state increments).double[]
Duration. getAdditionalState(SpacecraftState state)
Get the additional state.double[]
MedianDate. 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
Duration. yields(SpacecraftState state)
Check if this provider should yield so another provider has an opportunity to add missing parts.boolean
MedianDate. 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. -
Uses of SpacecraftState in org.orekit.forces.maneuvers.propulsion
Methods in org.orekit.forces.maneuvers.propulsion with parameters of type SpacecraftState Modifier and Type Method Description Vector3D
PropulsionModel. getAcceleration(SpacecraftState s, Attitude maneuverAttitude, double[] parameters)
Get the acceleration of the spacecraft during maneuver and in maneuver frame.default Vector3D
ThrustPropulsionModel. getAcceleration(SpacecraftState s, Attitude maneuverAttitude, double[] parameters)
Get the acceleration of the spacecraft during maneuver and in maneuver frame.default Vector3D
ThrustPropulsionModel. getDirection(SpacecraftState s)
Get the thrust direction in spacecraft frame.double
AbstractConstantThrustPropulsionModel. getFlowRate(SpacecraftState s)
Get the flow rate (kg/s).double
AbstractConstantThrustPropulsionModel. getFlowRate(SpacecraftState s, double[] parameters)
Get the flow rate (kg/s).double
ProfileThrustPropulsionModel. 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)
Get the flow rate (kg/s).double
ThrustPropulsionModel. getFlowRate(SpacecraftState s, double[] parameters)
Get the flow rate (kg/s).default double
ThrustPropulsionModel. getIsp(SpacecraftState s)
Get the specific impulse (s).double
PropulsionModel. getMassDerivatives(SpacecraftState s, double[] parameters)
Get the mass derivative (i.e.default double
ThrustPropulsionModel. getMassDerivatives(SpacecraftState s, double[] parameters)
Get the mass derivative (i.e.Vector3D
AbstractConstantThrustPropulsionModel. getThrustVector(SpacecraftState s)
Get the thrust vector in spacecraft frame (N).Vector3D
AbstractConstantThrustPropulsionModel. getThrustVector(SpacecraftState s, double[] parameters)
Get the thrust vector in spacecraft frame (N).Vector3D
ProfileThrustPropulsionModel. getThrustVector(SpacecraftState s)
Get the thrust vector in spacecraft frame (N).Vector3D
ProfileThrustPropulsionModel. getThrustVector(SpacecraftState s, double[] parameters)
Get the thrust vector in spacecraft frame (N).Vector3D
ThrustPropulsionModel. getThrustVector(SpacecraftState s)
Get the thrust vector in spacecraft frame (N).Vector3D
ThrustPropulsionModel. getThrustVector(SpacecraftState s, double[] parameters)
Get the thrust vector in spacecraft frame (N).default void
PropulsionModel. init(SpacecraftState initialState, AbsoluteDate target)
Initialization method. -
Uses of SpacecraftState in org.orekit.forces.maneuvers.trigger
Methods in org.orekit.forces.maneuvers.trigger that return SpacecraftState Modifier and Type Method Description protected SpacecraftState
AbstractManeuverTriggers. applyResetters(SpacecraftState state)
Apply resetters.SpacecraftState
ManeuverTriggersResetter. resetState(SpacecraftState state)
Reset state as a maneuver triggers.Methods in org.orekit.forces.maneuvers.trigger with parameters of type SpacecraftState Modifier and Type Method Description protected SpacecraftState
AbstractManeuverTriggers. applyResetters(SpacecraftState state)
Apply resetters.void
AbstractManeuverTriggers. init(SpacecraftState initialState, AbsoluteDate target)
Initialization method called at propagation start.void
IntervalEventTrigger. 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.default void
ManeuverTriggersResetter. 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. -
Uses of SpacecraftState in org.orekit.forces.radiation
Methods in org.orekit.forces.radiation with parameters of type SpacecraftState Modifier and Type Method Description Vector3D
ECOM2. acceleration(SpacecraftState s, double[] parameters)
Compute acceleration.Vector3D
KnockeRediffusedForceModel. acceleration(SpacecraftState s, double[] parameters)
Compute acceleration.Vector3D
RadiationPressureModel. acceleration(SpacecraftState s, double[] parameters)
Compute acceleration.Vector3D
SolarRadiationPressure. acceleration(SpacecraftState s, double[] parameters)
Compute acceleration.Vector3D
KnockeRediffusedForceModel. computeElementaryFlux(SpacecraftState state, Vector3D elementCenter, Vector3D sunPosition, OneAxisEllipsoid earth, double elementArea)
Compute elementary rediffused flux on satellite.Vector3D
AbstractLightFluxModel. getLightFluxVector(SpacecraftState state)
Get the light flux vector in the state's frame.Vector3D
LightFluxModel. getLightFluxVector(SpacecraftState state)
Get the light flux vector in the state's frame.double
AbstractLightFluxModel. getLightingRatio(SpacecraftState state)
Get the lighting ratio ([0-1]).double
SolarRadiationPressure. getLightingRatio(SpacecraftState state)
Get the lighting ratio ([0-1]).void
ConicallyShadowedLightFluxModel. init(SpacecraftState initialState, AbsoluteDate targetDate)
Perform initialization steps before starting propagation.default void
LightFluxModel. init(SpacecraftState initialState, AbsoluteDate targetDate)
Perform initialization steps before starting propagation.void
RadiationPressureModel. init(SpacecraftState initialState, AbsoluteDate target)
Initialize the force model at the start of propagation.Vector3D
IsotropicRadiationClassicalConvention. radiationPressureAcceleration(SpacecraftState state, Vector3D flux, double[] parameters)
Compute the acceleration due to radiation pressure.Vector3D
IsotropicRadiationCNES95Convention. radiationPressureAcceleration(SpacecraftState state, Vector3D flux, double[] parameters)
Compute the acceleration due to radiation pressure.Vector3D
IsotropicRadiationSingleCoefficient. radiationPressureAcceleration(SpacecraftState state, Vector3D flux, double[] parameters)
Compute the acceleration due to radiation pressure.Vector3D
RadiationSensitive. radiationPressureAcceleration(SpacecraftState state, Vector3D flux, double[] parameters)
Compute the acceleration due to radiation pressure. -
Uses of SpacecraftState in org.orekit.models.earth.ionosphere
Methods in org.orekit.models.earth.ionosphere with parameters of type SpacecraftState Modifier and Type Method Description 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
GlobalIonosphereMapModel. pathDelay(SpacecraftState state, TopocentricFrame baseFrame, double frequency, double[] parameters)
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
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. -
Uses of SpacecraftState in org.orekit.orbits
Methods in org.orekit.orbits with parameters of type SpacecraftState Modifier and Type Method Description PVCoordinates
LibrationOrbit. getManifolds(SpacecraftState s, boolean isStable)
Return a manifold direction from one position on a libration Orbit. -
Uses of SpacecraftState in org.orekit.propagation
Methods in org.orekit.propagation that return SpacecraftState Modifier and Type Method Description SpacecraftState
SpacecraftState. addAdditionalState(String name, double... value)
Add an additional state.SpacecraftState
SpacecraftState. addAdditionalStateDerivative(String name, double... value)
Add an additional state derivative.abstract SpacecraftState
AbstractStateModifier. change(SpacecraftState state)
Change main state.SpacecraftState
AbstractPropagator. getInitialState()
Get the propagator initial state.SpacecraftState
Propagator. 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
AbstractPropagator. propagate(AbsoluteDate target)
Propagate towards a target date.SpacecraftState
Propagator. 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.SpacecraftState
AbstractStateModifier. update(SpacecraftState state)
Update a state.default SpacecraftState
AdditionalStateProvider. update(SpacecraftState state)
Update a state.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.Methods in org.orekit.propagation that return types with arguments of type SpacecraftState Modifier and Type Method Description List<SpacecraftState>
PropagatorsParallelizer. propagate(AbsoluteDate start, AbsoluteDate target)
Propagate from a start date towards a target date.Methods in org.orekit.propagation with parameters of type SpacecraftState Modifier and Type Method Description abstract SpacecraftState
AbstractStateModifier. change(SpacecraftState state)
Change main state.void
SpacecraftState. ensureCompatibleAdditionalStates(SpacecraftState state)
Check if two instances have the same set of additional states available.double[]
AbstractStateModifier. getAdditionalState(SpacecraftState state)
Get the additional state.double[]
AdditionalStateProvider. getAdditionalState(SpacecraftState state)
Get the additional state.double[]
StateCovarianceMatrixProvider. 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.RealMatrix
AbstractMatricesHarvester. getParametersJacobian(SpacecraftState state)
Get the Jacobian with respect to propagation parameters.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.RealMatrix
AbstractMatricesHarvester. getStateTransitionMatrix(SpacecraftState state)
Extract state transition matrix from state.RealMatrix
MatricesHarvester. getStateTransitionMatrix(SpacecraftState state)
Extract state transition matrix from state.default void
AdditionalStateProvider. init(SpacecraftState initialState, AbsoluteDate target)
Initialize the additional state provider at the start of propagation.void
StateCovarianceMatrixProvider. init(SpacecraftState initialState, AbsoluteDate target)
Initialize the additional state provider at the start of propagation.void
AbstractPropagator. resetInitialState(SpacecraftState state)
Reset the propagator initial state.void
Propagator. 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.SpacecraftState
AbstractStateModifier. update(SpacecraftState state)
Update a state.default SpacecraftState
AdditionalStateProvider. update(SpacecraftState state)
Update a state.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.default boolean
AdditionalStateProvider. yields(SpacecraftState state)
Check if this provider should yield so another provider has an opportunity to add missing parts.boolean
StateCovarianceMatrixProvider. yields(SpacecraftState state)
Check if this provider should yield so another provider has an opportunity to add missing parts.Method parameters in org.orekit.propagation with type arguments of type SpacecraftState Modifier and Type Method 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.Constructors in org.orekit.propagation with parameters of type SpacecraftState Constructor Description FieldSpacecraftState(Field<T> field, SpacecraftState state)
Convert aFieldSpacecraftState
. -
Uses of SpacecraftState in org.orekit.propagation.analytical
Methods in org.orekit.propagation.analytical that return SpacecraftState Modifier and Type Method 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 aspacecraft state
.SpacecraftState
J2DifferentialEffect. apply(SpacecraftState state1)
Apply the effect to aspacecraft state
.protected SpacecraftState
AbstractAnalyticalPropagator. basicPropagate(AbsoluteDate date)
Propagate an orbit without any fancy features.protected SpacecraftState
AdapterPropagator. basicPropagate(AbsoluteDate date)
Propagate an orbit without any fancy features.protected SpacecraftState
AggregateBoundedPropagator. basicPropagate(AbsoluteDate date)
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.Methods in org.orekit.propagation.analytical that return types with arguments of type SpacecraftState Modifier and Type Method Description TimeInterpolator<SpacecraftState>
Ephemeris. getStateInterpolator()
Get state interpolator.Methods in org.orekit.propagation.analytical with parameters of type SpacecraftState Modifier and Type Method Description SpacecraftState
AdapterPropagator.DifferentialEffect. apply(SpacecraftState original)
Apply the effect to aspacecraft state
.SpacecraftState
J2DifferentialEffect. apply(SpacecraftState state1)
Apply the effect to aspacecraft state
.double[]
AbstractAnalyticalMatricesHarvester. getAdditionalState(SpacecraftState state)
Get the additional state.RealMatrix
AbstractAnalyticalMatricesHarvester. getParametersJacobian(SpacecraftState state)
Get the Jacobian with respect to propagation parameters.RealMatrix
AbstractAnalyticalMatricesHarvester. getStateTransitionMatrix(SpacecraftState state)
Extract state transition matrix from state.void
AdapterPropagator. resetInitialState(SpacecraftState state)
Reset the propagator initial state.void
AggregateBoundedPropagator. resetInitialState(SpacecraftState state)
void
BrouwerLyddanePropagator. resetInitialState(SpacecraftState state)
Reset the propagator initial state.void
BrouwerLyddanePropagator. resetInitialState(SpacecraftState state, PropagationType stateType)
Reset the propagator initial state.void
BrouwerLyddanePropagator. resetInitialState(SpacecraftState state, PropagationType stateType, double epsilon, int maxIterations)
Reset the propagator initial state.void
EcksteinHechlerPropagator. resetInitialState(SpacecraftState state)
Reset the propagator initial state.void
EcksteinHechlerPropagator. 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
Ephemeris. resetInitialState(SpacecraftState state)
Try (and fail) to reset the initial state.void
KeplerianPropagator. resetInitialState(SpacecraftState state)
Reset the propagator initial state.protected abstract void
AbstractAnalyticalPropagator. 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 void
BrouwerLyddanePropagator. resetIntermediateState(SpacecraftState state, boolean forward)
Reset an intermediate state.protected void
BrouwerLyddanePropagator. resetIntermediateState(SpacecraftState state, boolean forward, double epsilon, int maxIterations)
Reset an intermediate state.protected void
EcksteinHechlerPropagator. 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
Ephemeris. resetIntermediateState(SpacecraftState state, boolean forward)
Reset an intermediate state.protected void
KeplerianPropagator. resetIntermediateState(SpacecraftState state, boolean forward)
Reset an intermediate state.void
AbstractAnalyticalMatricesHarvester. setReferenceState(SpacecraftState reference)
Set up reference state.Method parameters in org.orekit.propagation.analytical with type arguments of type SpacecraftState Modifier and Type Method 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.Constructors in org.orekit.propagation.analytical with parameters of type SpacecraftState Constructor 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 parameters in org.orekit.propagation.analytical with type arguments of type SpacecraftState Constructor 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, 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.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. -
Uses of SpacecraftState in org.orekit.propagation.analytical.gnss
Methods in org.orekit.propagation.analytical.gnss with parameters of type SpacecraftState Modifier and Type Method Description double[]
ClockCorrectionsProvider. getAdditionalState(SpacecraftState state)
Get the additional state.void
GLONASSAnalyticalPropagator. resetInitialState(SpacecraftState state)
Reset the propagator initial state.void
GNSSPropagator. resetInitialState(SpacecraftState state)
Reset the propagator initial state.void
SBASPropagator. resetInitialState(SpacecraftState state)
Reset the propagator initial state.protected void
GLONASSAnalyticalPropagator. resetIntermediateState(SpacecraftState state, boolean forward)
Reset an intermediate state.protected void
GNSSPropagator. resetIntermediateState(SpacecraftState state, boolean forward)
Reset an intermediate state.protected void
SBASPropagator. resetIntermediateState(SpacecraftState state, boolean forward)
Reset an intermediate state. -
Uses of SpacecraftState in org.orekit.propagation.analytical.intelsat
Methods in org.orekit.propagation.analytical.intelsat with parameters of type SpacecraftState Modifier and Type Method Description void
IntelsatElevenElementsPropagator. resetInitialState(SpacecraftState state)
Reset the propagator initial state.protected void
IntelsatElevenElementsPropagator. resetIntermediateState(SpacecraftState state, boolean forward)
Reset an intermediate state. -
Uses of SpacecraftState in org.orekit.propagation.analytical.tle
Methods in org.orekit.propagation.analytical.tle with parameters of type SpacecraftState Modifier and Type Method 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. -
Uses of SpacecraftState in org.orekit.propagation.analytical.tle.generation
Methods in org.orekit.propagation.analytical.tle.generation with parameters of type SpacecraftState Modifier and Type Method Description TLE
FixedPointTleGenerationAlgorithm. 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
TleGenerationAlgorithm. generate(SpacecraftState state, TLE templateTLE)
Generate a TLE from a given spacecraft state and a template TLE. -
Uses of SpacecraftState in org.orekit.propagation.conversion
Methods in org.orekit.propagation.conversion that return SpacecraftState Modifier and Type Method Description SpacecraftState
OsculatingToMeanElementsConverter. convert()
Convert an osculating orbit into a mean orbit, in DSST sense.Methods in org.orekit.propagation.conversion that return types with arguments of type SpacecraftState Modifier and Type Method Description protected List<SpacecraftState>
AbstractPropagatorConverter. getSample()
Get the states sample.Method parameters in org.orekit.propagation.conversion with type arguments of type SpacecraftState Modifier and Type Method Description Propagator
AbstractPropagatorConverter. convert(List<SpacecraftState> states, boolean positionOnly, String... freeParameters)
Find the propagator that minimize the mean square error for a sample ofstates
.Propagator
AbstractPropagatorConverter. convert(List<SpacecraftState> states, boolean positionOnly, List<String> freeParameters)
Find the propagator that minimize the mean square error for a sample ofstates
.Propagator
PropagatorConverter. convert(List<SpacecraftState> states, boolean positionOnly, String... freeParameters)
Find the propagator that minimize the mean square error for a sample ofstates
.Propagator
PropagatorConverter. convert(List<SpacecraftState> states, boolean positionOnly, List<String> freeParameters)
Find the propagator that minimize the mean square error for a sample ofstates
.Constructors in org.orekit.propagation.conversion with parameters of type SpacecraftState Constructor Description OsculatingToMeanElementsConverter(SpacecraftState state, int satelliteRevolution, Propagator propagator, double positionScale)
Constructor. -
Uses of SpacecraftState in org.orekit.propagation.events
Methods in org.orekit.propagation.events that return SpacecraftState Modifier and Type Method Description SpacecraftState
EventState.EventOccurrence. getNewState()
Get the new state for a reset action.SpacecraftState
EventsLogger.LoggedEvent. getState()
Get the triggering state.Methods in org.orekit.propagation.events that return types with arguments of type SpacecraftState Modifier and Type Method Description ToDoubleFunction<SpacecraftState>
FunctionalDetector. getFunction()
Get the switching function.Methods in org.orekit.propagation.events with parameters of type SpacecraftState Modifier and Type Method Description static double
BetaAngleDetector. calculateBetaAngle(SpacecraftState state, PVCoordinatesProvider celestialBodyProvider)
Calculate the beta angle between the orbit plane and the celestial body.static double
BetaAngleDetector. calculateBetaAngle(SpacecraftState state, PVCoordinatesProvider celestialBodyProvider, Frame frame)
Calculate the beta angle between the orbit plane and the celestial body.PVCoordinates
ExtremumApproachDetector. computeDeltaPV(SpacecraftState s)
Deprecated.The output type of this method shall be modified in the future to improve code efficiency (though it will still give access to the relative position and velocity)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.void
AdapterDetector. finish(SpacecraftState state)
This method finalizes the event detector's job.default void
EventDetector. finish(SpacecraftState state)
This method finalizes the event detector's job.void
EventState. finish(SpacecraftState state)
This method finalizes the event detector's job.double
AdapterDetector. g(SpacecraftState s)
Compute the value of the switching function.double
AlignmentDetector. g(SpacecraftState s)
Compute the value of the switching function.double
AltitudeDetector. g(SpacecraftState s)
Compute the value of the switching function.double
AngularSeparationDetector. g(SpacecraftState s)
Compute the value of the switching function.double
AngularSeparationFromSatelliteDetector. g(SpacecraftState s)
Compute the value of the switching function.double
ApsideDetector. g(SpacecraftState s)
Compute the value of the switching function.double
BetaAngleDetector. g(SpacecraftState s)
Compute the value of the switching function.double
BooleanDetector. g(SpacecraftState s)
double
CylindricalShadowEclipseDetector. g(SpacecraftState s)
Compute the value of the switching function.double
DateDetector. g(SpacecraftState s)
Compute the value of the switching function.double
EclipseDetector. g(SpacecraftState s)
Compute the value of the switching function.double
ElevationDetector. g(SpacecraftState s)
Compute the value of the switching function.double
ElevationExtremumDetector. g(SpacecraftState s)
Compute the value of the detection function.double
EventDetector. g(SpacecraftState s)
Compute the value of the switching function.double
EventEnablingPredicateFilter. g(SpacecraftState s)
Compute the value of the switching function.double
EventShifter. g(SpacecraftState s)
Compute the value of the switching function.double
EventSlopeFilter. g(SpacecraftState s)
Compute the value of the switching function.double
ExtremumApproachDetector. g(SpacecraftState s)
Theg
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
FieldOfViewDetector. g(SpacecraftState s)
Compute the value of the switching function.double
FootprintOverlapDetector. g(SpacecraftState s)
Compute the value of the switching function.double
FunctionalDetector. g(SpacecraftState s)
double
GeographicZoneDetector. g(SpacecraftState s)
Compute the value of the detection function.double
GroundAtNightDetector. g(SpacecraftState state)
Compute the value of the switching function.double
GroundFieldOfViewDetector. g(SpacecraftState s)
Compute the value of the switching function.double
HaloXZPlaneCrossingDetector. g(SpacecraftState s)
Compute the value of the detection function.double
InterSatDirectViewDetector. g(SpacecraftState state)
Compute the value of the switching function.double
LatitudeCrossingDetector. g(SpacecraftState s)
Compute the value of the detection function.double
LatitudeExtremumDetector. g(SpacecraftState s)
Compute the value of the detection function.double
LatitudeRangeCrossingDetector. g(SpacecraftState s)
Compute the value of the detection function.double
LongitudeCrossingDetector. g(SpacecraftState s)
Compute the value of the detection function.double
LongitudeExtremumDetector. g(SpacecraftState s)
Compute the value of the detection function.double
LongitudeRangeCrossingDetector. g(SpacecraftState s)
Compute the value of the detection function.double
MagneticFieldDetector. g(SpacecraftState s)
Compute the value of the detection function.double
NegateDetector. g(SpacecraftState s)
double
NodeDetector. g(SpacecraftState s)
Compute the value of the switching function.double
ParameterDrivenDateIntervalDetector. g(SpacecraftState s)
Compute the value of the switching function.double
PositionAngleDetector. g(SpacecraftState s)
Compute the value of the detection function.double
RelativeDistanceDetector. g(SpacecraftState s)
Theg
is positive when the relative distance is larger or equal than the threshold, non-positive otherwise.double
ElevationExtremumDetector. getElevation(SpacecraftState s)
Get the elevation value.void
AbstractDetector. 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
BooleanDetector. init(SpacecraftState s0, AbsoluteDate t)
default void
EventDetector. init(SpacecraftState s0, AbsoluteDate t)
Initialize event handler at the start of a propagation.void
EventEnablingPredicateFilter. init(SpacecraftState s0, AbsoluteDate t)
Initialize event handler at the start of a propagation.void
EventShifter. 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.void
EventState. 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
MagneticFieldDetector. init(SpacecraftState s0, AbsoluteDate t)
Initialize event handler at the start of a propagation.void
NegateDetector. init(SpacecraftState s0, AbsoluteDate t)
void
PositionAngleDetector. 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.Method parameters in org.orekit.propagation.events with type arguments of type SpacecraftState Modifier and Type Method Description FunctionalDetector
FunctionalDetector. withFunction(ToDoubleFunction<SpacecraftState> newGFunction)
Create a new event detector with a new g function, keeping all other attributes the same.Constructor parameters in org.orekit.propagation.events with type arguments of type SpacecraftState Constructor Description FunctionalDetector(AdaptableInterval maxCheck, double threshold, int maxIter, EventHandler handler, ToDoubleFunction<SpacecraftState> function)
Private constructor. -
Uses of SpacecraftState in org.orekit.propagation.events.handlers
Methods in org.orekit.propagation.events.handlers that return SpacecraftState Modifier and Type Method 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.SpacecraftState
RecallLastOccurrence. resetState(EventDetector detector, SpacecraftState oldState)
Reset the state prior to continue propagation.Methods in org.orekit.propagation.events.handlers with parameters of type SpacecraftState Modifier and Type Method Description Action
ContinueOnEvent. eventOccurred(SpacecraftState s, EventDetector detector, boolean increasing)
Specific implementation of the eventOccurred interface.Action
EventHandler. eventOccurred(SpacecraftState s, EventDetector detector, boolean increasing)
Handle an event.Action
EventMultipleHandler. eventOccurred(SpacecraftState s, EventDetector detector, boolean increasing)
Handle an event.Action
RecallLastOccurrence. eventOccurred(SpacecraftState s, EventDetector detector, boolean increasing)
Handle an event.Action
RecordAndContinue. eventOccurred(SpacecraftState s, EventDetector detector, boolean increasing)
Action
ResetDerivativesOnEvent. eventOccurred(SpacecraftState s, EventDetector detector, boolean increasing)
Specific implementation of the eventOccurred interface.Action
StopOnDecreasing. eventOccurred(SpacecraftState s, EventDetector detector, boolean increasing)
Handle a detection event and choose what to do next.Action
StopOnEvent. eventOccurred(SpacecraftState s, EventDetector detector, boolean increasing)
Specific implementation of the eventOccurred interface.Action
StopOnIncreasing. eventOccurred(SpacecraftState s, EventDetector detector, boolean increasing)
Handle a detection event and choose what to do next.default void
EventHandler. finish(SpacecraftState finalState, EventDetector detector)
This method finalizes the event handler's job.void
EventMultipleHandler. finish(SpacecraftState finalState, EventDetector detector)
void
RecallLastOccurrence. finish(SpacecraftState finalState, EventDetector detector)
This method finalizes the event handler's job.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.void
RecallLastOccurrence. 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.SpacecraftState
RecallLastOccurrence. resetState(EventDetector detector, SpacecraftState oldState)
Reset the state prior to continue propagation. -
Uses of SpacecraftState in org.orekit.propagation.integration
Methods in org.orekit.propagation.integration that return SpacecraftState Modifier and Type Method 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.SpacecraftState
StateMapper. mapArrayToState(double t, double[] y, double[] yDot, PropagationType type)
Map the raw double components to a spacecraft state.abstract SpacecraftState
StateMapper. mapArrayToState(AbsoluteDate date, 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.Methods in org.orekit.propagation.integration with parameters of type SpacecraftState Modifier and Type Method Description protected void
AbstractIntegratedPropagator. beforeIntegration(SpacecraftState initialState, AbsoluteDate tEnd)
Method called just before integration.protected static FieldSpacecraftState<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
AbstractIntegratedPropagator.MainStateEquations. init(SpacecraftState initialState, AbsoluteDate target)
Initialize the equations at the start of propagation.default void
AdditionalDerivativesProvider. init(SpacecraftState initialState, AbsoluteDate target)
Initialize the generator at the start of propagation.abstract void
StateMapper. mapStateToArray(SpacecraftState state, double[] y, double[] yDot)
Map a spacecraft state to raw double components.void
AbstractIntegratedPropagator. resetInitialState(SpacecraftState state, PropagationType stateType)
Reset initial state with a given propagation type.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. -
Uses of SpacecraftState in org.orekit.propagation.numerical
Methods in org.orekit.propagation.numerical that return SpacecraftState Modifier and Type Method 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.Methods in org.orekit.propagation.numerical with parameters of type SpacecraftState Modifier and Type Method 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. -
Uses of SpacecraftState in org.orekit.propagation.numerical.cr3bp
Methods in org.orekit.propagation.numerical.cr3bp that return SpacecraftState Modifier and Type Method 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.Methods in org.orekit.propagation.numerical.cr3bp with parameters of type SpacecraftState Modifier and Type Method Description 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).DerivativeStructure
CR3BPForceModel. getPotential(SpacecraftState s)
Calculate spacecraft potential.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.Method parameters in org.orekit.propagation.numerical.cr3bp with type arguments of type SpacecraftState Modifier and Type Method 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 parameters in org.orekit.propagation.numerical.cr3bp with type arguments of type SpacecraftState Constructor Description CR3BPMultipleShooter(List<SpacecraftState> initialGuessList, List<NumericalPropagator> propagatorList, List<STMEquations> stmEquations, double tolerance, int maxIter)
Simple Constructor. -
Uses of SpacecraftState in org.orekit.propagation.sampling
Methods in org.orekit.propagation.sampling that return SpacecraftState Modifier and Type Method 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.Methods in org.orekit.propagation.sampling with parameters of type SpacecraftState Modifier and Type Method Description default void
OrekitFixedStepHandler. finish(SpacecraftState finalState)
Finalize propagation.default void
OrekitStepHandler. finish(SpacecraftState finalState)
Finalize propagation.void
OrekitStepNormalizer. finish(SpacecraftState finalState)
Finalize propagation.void
StepHandlerMultiplexer. finish(SpacecraftState finalState)
Finalize propagation.void
OrekitFixedStepHandler. handleStep(SpacecraftState currentState)
Handle the current step.default void
OrekitFixedStepHandler. init(SpacecraftState s0, AbsoluteDate t, double step)
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
OrekitStepNormalizer. 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.OrekitStepInterpolator
OrekitStepInterpolator. restrictStep(SpacecraftState newPreviousState, SpacecraftState newCurrentState)
Create a new restricted version of the instance.Method parameters in org.orekit.propagation.sampling with type arguments of type SpacecraftState Modifier and Type Method Description default void
MultiSatFixedStepHandler. finish(List<SpacecraftState> finalStates)
Finalize propagation.default void
MultiSatStepHandler. finish(List<SpacecraftState> finalStates)
Finalize propagation.void
MultisatStepNormalizer. finish(List<SpacecraftState> finalStates)
Finalize propagation.void
MultiSatFixedStepHandler. handleStep(List<SpacecraftState> states)
Handle the current step.default void
MultiSatFixedStepHandler. init(List<SpacecraftState> states0, AbsoluteDate t, double step)
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.void
MultisatStepNormalizer. init(List<SpacecraftState> s0, AbsoluteDate t)
Initialize step handler at the start of a propagation. -
Uses of SpacecraftState in org.orekit.propagation.semianalytical.dsst
Methods in org.orekit.propagation.semianalytical.dsst that return SpacecraftState Modifier and Type Method 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.Methods in org.orekit.propagation.semianalytical.dsst with parameters of type SpacecraftState Modifier and Type Method 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.RealMatrix
DSSTHarvester. getB2(SpacecraftState state)
Get the Jacobian matrix B2 (B2 = ∂Y/∂Y₀).RealMatrix
DSSTHarvester. getB3(SpacecraftState state)
Get the Jacobian matrix B3 (B3 = ∂Y/∂P).RealMatrix
DSSTHarvester. getParametersJacobian(SpacecraftState state)
Get the Jacobian with respect to propagation parameters.double[]
DSSTPropagator. getShortPeriodTermsValue(SpacecraftState meanState)
Get the short period terms value.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
DSSTHarvester. initializeFieldShortPeriodTerms(SpacecraftState reference, PropagationType type)
Initialize the short periodic terms for the "field" elements.void
DSSTPropagator. resetInitialState(SpacecraftState state)
Reset the initial state.void
DSSTPropagator. resetInitialState(SpacecraftState state, PropagationType stateType)
Reset initial state with a given propagation type.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. -
Uses of SpacecraftState in org.orekit.propagation.semianalytical.dsst.forces
Methods in org.orekit.propagation.semianalytical.dsst.forces with parameters of type SpacecraftState Modifier and Type Method 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[]
DSSTAtmosphericDrag. 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[]
AbstractGaussianContribution. getMeanElementRate(SpacecraftState state, AbstractGaussianContribution.GaussQuadrature gauss, double low, double high, AbstractGaussianContributionContext context, 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[]
DSSTForceModel. getMeanElementRate(SpacecraftState state, 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[]
DSSTNewtonianAttraction. 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[]
DSSTThirdBody. getMeanElementRate(SpacecraftState currentState, AuxiliaryElements auxiliaryElements, 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.void
AbstractGaussianContribution. init(SpacecraftState initialState, AbsoluteDate target)
Initialize the force model at the start of propagation.default void
DSSTForceModel. init(SpacecraftState initialState, AbsoluteDate target)
Initialize the force model at the start of propagation.void
AbstractGaussianContribution. updateShortPeriodTerms(double[] parameters, SpacecraftState... meanStates)
Update the short period terms.void
DSSTForceModel. updateShortPeriodTerms(double[] parameters, SpacecraftState... meanStates)
Update the short period terms.void
DSSTJ2SquaredClosedForm. updateShortPeriodTerms(double[] parameters, SpacecraftState... meanStates)
Update the short period terms.void
DSSTNewtonianAttraction. updateShortPeriodTerms(double[] parameters, SpacecraftState... meanStates)
Update the short period terms.void
DSSTTesseral. updateShortPeriodTerms(double[] parameters, SpacecraftState... meanStates)
Update the short period terms.void
DSSTThirdBody. updateShortPeriodTerms(double[] parameters, SpacecraftState... meanStates)
Update the short period terms.void
DSSTZonal. updateShortPeriodTerms(double[] parameters, SpacecraftState... meanStates)
Update the short period terms.default void
J2SquaredModel. updateShortPeriodTerms(double[] parameters, SpacecraftState... meanStates)
Update the J2-squared short period terms. -
Uses of SpacecraftState in org.orekit.utils
Methods in org.orekit.utils that return SpacecraftState Modifier and Type Method Description protected abstract SpacecraftState
AbstractMultipleShooting. getAugmentedInitialState(int i)
Compute the additional state from the additionalEquations.protected SpacecraftState
MultipleShooter. getAugmentedInitialState(int i)
Compute the additional state from the additionalEquations.protected SpacecraftState
AbstractMultipleShooting. getPatchPoint(int i)
Get a patch point.Methods in org.orekit.utils that return types with arguments of type SpacecraftState Modifier and Type Method 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.Methods in org.orekit.utils with parameters of type SpacecraftState Modifier and Type Method 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.Method parameters in org.orekit.utils with type arguments of type SpacecraftState Modifier and Type Method Description protected abstract double[]
AbstractMultipleShooting. computeAdditionalConstraints(List<SpacecraftState> propagatedSP)
Compute the additional constraints.protected double[]
MultipleShooter. computeAdditionalConstraints(List<SpacecraftState> propagatedSP)
Compute the additional constraints.protected abstract double[][]
AbstractMultipleShooting. computeAdditionalJacobianMatrix(List<SpacecraftState> propagatedSP)
Compute a part of the Jacobian matrix from additional constraints.protected double[][]
MultipleShooter. 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 parameters in org.orekit.utils with type arguments of type SpacecraftState Constructor 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.
-