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.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 ofSpacecraftStateinto 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 with parameters of type SpacecraftState Modifier and Type Method Description voidAttitudesSequence.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.estimation.measurements
Methods in org.orekit.estimation.measurements that return SpacecraftState Modifier and Type Method Description SpacecraftStateCommonParametersWithDerivatives. getState()Get spacecraft state.SpacecraftStateCommonParametersWithoutDerivatives. getState()Get spacecraft state.SpacecraftState[]EstimatedMeasurementBase. getStates()Get the states of the spacecrafts.SpacecraftStateCommonParametersWithDerivatives. getTransitState()Get transit state.SpacecraftStateCommonParametersWithoutDerivatives. getTransitState()Get transit state.Methods in org.orekit.estimation.measurements with parameters of type SpacecraftState Modifier and Type Method Description protected GroundReceiverCommonParametersWithDerivativesGroundReceiverMeasurement. computeCommonParametersWithDerivatives(SpacecraftState state)Compute common estimation parameters.protected GroundReceiverCommonParametersWithoutDerivativesGroundReceiverMeasurement. 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 voidElevationFilter. filter(ObservedMeasurement<T> measurement, SpacecraftState state)Apply a filter to an observed measurement.voidMeasurementFilter. filter(ObservedMeasurement<T> measurement, SpacecraftState state)Apply a filter to an observed measurement.voidResidualFilter. 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 TMeasurementBuilder. 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 OnBoardCommonParametersWithDerivativesAbstractOnBoardMeasurement. computeCommonParametersWith(SpacecraftState[] states, boolean clockOffsetAlreadyApplied)Compute common estimation parameters.protected OnBoardCommonParametersWithoutDerivativesAbstractOnBoardMeasurement. computeCommonParametersWithout(SpacecraftState[] states, boolean clockOffsetAlreadyApplied)Compute common estimation parameters.protected PVCoordinatesProviderAbstractInterSatellitesMeasurement. 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 PVCoordinatesProviderAbstractOnBoardMeasurement. 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 PVCoordinatesProviderAbstractOneWayGNSSMeasurement. 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 doubleParametricModelEffect. evaluate(GroundStation station, SpacecraftState state)Evaluate the parametric model effect.protected doubleBaseRangeIonosphericDelayModifier. rangeErrorIonosphericModel(GroundStation station, SpacecraftState state)Compute the measurement error due to Ionosphere.doubleBaseRangeTroposphericDelayModifier. rangeErrorTroposphericModel(GroundStation station, SpacecraftState state)Compute the measurement error due to Troposphere.protected doubleBaseRangeRateIonosphericDelayModifier. rangeRateErrorIonosphericModel(GroundStation station, SpacecraftState state)Compute the measurement error due to Ionosphere.protected doubleRangeRateIonosphericDelayModifier. rangeRateErrorIonosphericModel(GroundStation station, SpacecraftState state)Compute the measurement error due to Ionosphere.doubleBaseRangeRateTroposphericDelayModifier. rangeRateErrorTroposphericModel(GroundStation station, SpacecraftState state)Compute the measurement error due to Troposphere.doubleRangeRateTroposphericDelayModifier. 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.RealMatrixAbstractCovarianceMatrixProvider. getInitialCovarianceMatrix(SpacecraftState initial)Get the initial covariance matrix.RealMatrixCovarianceMatrixProvider. getInitialCovarianceMatrix(SpacecraftState initial)Get the initial covariance matrix.RealMatrixConstantProcessNoise. getProcessNoiseMatrix(SpacecraftState previous, SpacecraftState current)Get the process noise matrix between previous and current states.RealMatrixCovarianceMatrixProvider. getProcessNoiseMatrix(SpacecraftState previous, SpacecraftState current)Get the process noise matrix between previous and current states.RealMatrixUnivariateProcessNoise. getProcessNoiseMatrix(SpacecraftState previous, SpacecraftState current)Get the process noise matrix between previous and current states.voidSemiAnalyticalMeasurementHandler. init(SpacecraftState s0, AbsoluteDate t)Initialize step handler at the start of a propagation.voidSemiAnalyticalKalmanModel. initializeShortPeriodicTerms(SpacecraftState meanState)Initialize the short periodic terms for the Kalman Filter.voidSemiAnalyticalProcess. initializeShortPeriodicTerms(SpacecraftState meanState)Initialize the short periodic terms for the Kalman Filter.voidSemiAnalyticalUnscentedKalmanModel. initializeShortPeriodicTerms(SpacecraftState meanState)Initialize the short periodic terms for the Kalman Filter.voidSemiAnalyticalKalmanModel. updateNominalSpacecraftState(SpacecraftState nominal)Update the nominal spacecraft state.voidSemiAnalyticalProcess. updateNominalSpacecraftState(SpacecraftState nominal)Update the nominal spacecraft state.voidSemiAnalyticalUnscentedKalmanModel. updateNominalSpacecraftState(SpacecraftState nominal)Update the nominal spacecraft state.voidSemiAnalyticalKalmanModel. updateShortPeriods(SpacecraftState state)Update the DSST short periodic terms.voidSemiAnalyticalProcess. updateShortPeriods(SpacecraftState state)Update the DSST short periodic terms.voidSemiAnalyticalUnscentedKalmanModel. 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 voidStreamingAemWriter.SegmentWriter. finish(SpacecraftState finalState)Finalize propagation.voidStreamingAemWriter.SegmentWriter. handleStep(SpacecraftState currentState)Handle the current step.voidStreamingAemWriter.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 voidStreamingOcmWriter.BlockWriter. finish(SpacecraftState finalState)Finalize propagation.voidStreamingOcmWriter.BlockWriter. handleStep(SpacecraftState currentState)Handle the current step.voidStreamingOcmWriter.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 voidStreamingOemWriter.SegmentWriter. finish(SpacecraftState finalState)Finalize propagation.voidStreamingOemWriter.SegmentWriter. handleStep(SpacecraftState currentState)Handle the current step.voidStreamingOemWriter.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 SpacecraftStateOmm. generateSpacecraftState()Generate spacecraft state from theCartesianOrbitgenerated 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 SpacecraftStateOpm. generateSpacecraftState()Generate spacecraft state from theCartesianOrbitgenerated by generateCartesianOrbit. -
Uses of SpacecraftState in org.orekit.files.general
Methods in org.orekit.files.general that return SpacecraftState Modifier and Type Method Description SpacecraftStateEphemerisSegmentPropagator. getInitialState()Methods in org.orekit.files.general with parameters of type SpacecraftState Modifier and Type Method Description voidEphemerisSegmentPropagator. resetInitialState(SpacecraftState state)protected voidEphemerisSegmentPropagator. resetIntermediateState(SpacecraftState state, boolean forward)Method parameters in org.orekit.files.general with type arguments of type SpacecraftState Modifier and Type Method Description OrekitAttitudeEphemerisFile.OrekitAttitudeEphemerisSegmentOrekitAttitudeEphemerisFile.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.OrekitAttitudeEphemerisSegmentthat has been stored internally.OrekitEphemerisFile.OrekitEphemerisSegmentOrekitEphemerisFile.OrekitSatelliteEphemeris. addNewSegment(List<SpacecraftState> states)Injects pre-computed satellite states into this ephemeris file object, returning the generatedOrekitEphemerisFile.OrekitEphemerisSegmentthat has been stored internally.OrekitEphemerisFile.OrekitEphemerisSegmentOrekitEphemerisFile.OrekitSatelliteEphemeris. addNewSegment(List<SpacecraftState> states, int interpolationSampleSize)Injects pre-computed satellite states into this ephemeris file object, returning the generatedOrekitEphemerisFile.OrekitEphemerisSegmentthat has been stored internally.OrekitEphemerisFile.OrekitEphemerisSegmentOrekitEphemerisFile.OrekitSatelliteEphemeris. addNewSegment(List<SpacecraftState> states, CelestialBody body, int interpolationSampleSize)Injects pre-computed satellite states into this ephemeris file object, returning the generatedOrekitEphemerisFile.OrekitEphemerisSegmentthat has been stored internally.OrekitEphemerisFile.OrekitEphemerisSegmentOrekitEphemerisFile.OrekitSatelliteEphemeris. addNewSegment(List<SpacecraftState> states, CelestialBody body, int interpolationSampleSize, TimeScale timeScale)Injects pre-computed satellite states into this ephemeris file object, returning the generatedOrekitEphemerisFile.OrekitEphemerisSegmentthat 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 voidStreamingCpfWriter.Segment. finish(SpacecraftState finalState)Finalize propagation.voidStreamingCpfWriter.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 Vector3DForceModel. acceleration(SpacecraftState s, double[] parameters)Compute acceleration.default voidForceModel. addContribution(SpacecraftState s, TimeDerivativesEquations adder)Compute the contribution of the force model to the perturbing acceleration.Vector3DBoxAndSolarArraySpacecraft. dragAcceleration(SpacecraftState state, double density, Vector3D relativeVelocity, double[] parameters)Compute the acceleration due to drag.Vector3DFixedPanel. getNormal(SpacecraftState state)Get panel normal in spacecraft frame.abstract Vector3DPanel. getNormal(SpacecraftState state)Get panel normal in spacecraft frame.Vector3DPointingPanel. getNormal(SpacecraftState state)Get panel normal in spacecraft frame.Vector3DSlewingPanel. getNormal(SpacecraftState state)Get panel normal in spacecraft frame.default voidForceModel. init(SpacecraftState initialState, AbsoluteDate target)Initialize the force model at the start of propagation.Vector3DBoxAndSolarArraySpacecraft. 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 Vector3DDragForce. acceleration(SpacecraftState s, double[] parameters)Compute acceleration.Vector3DTimeSpanDragForce. acceleration(SpacecraftState s, double[] parameters)Deprecated.Compute acceleration.Vector3DDragSensitive. dragAcceleration(SpacecraftState state, double density, Vector3D relativeVelocity, double[] parameters)Compute the acceleration due to drag.Vector3DIsotropicDrag. 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 Vector3DParametricAcceleration. acceleration(SpacecraftState state, double[] parameters)Compute acceleration.Vector3DTimeSpanParametricAcceleration. acceleration(SpacecraftState state, double[] parameters)Compute acceleration.default voidAccelerationModel. init(SpacecraftState initialState, AbsoluteDate target)Initialize the acceleration model at the start of the propagation.voidHarmonicAccelerationModel. init(SpacecraftState initialState, AbsoluteDate target)Initialize the acceleration model at the start of the propagation.voidParametricAcceleration. init(SpacecraftState initialState, AbsoluteDate target)Initialize the force model at the start of propagation.voidPolynomialAccelerationModel. init(SpacecraftState initialState, AbsoluteDate target)Initialize the acceleration model at the start of the propagation.voidTimeSpanParametricAcceleration. init(SpacecraftState initialState, AbsoluteDate target)Initialize the force model at the start of propagation.doubleAccelerationModel. signedAmplitude(SpacecraftState state, double[] parameters)Compute the signed amplitude of the acceleration.doubleHarmonicAccelerationModel. signedAmplitude(SpacecraftState state, double[] parameters)Compute the signed amplitude of the acceleration.doublePolynomialAccelerationModel. 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 Vector3DDeSitterRelativity. acceleration(SpacecraftState s, double[] parameters)Compute acceleration.Vector3DHolmesFeatherstoneAttractionModel. acceleration(SpacecraftState s, double[] parameters)Compute acceleration.Vector3DJ2OnlyPerturbation. acceleration(SpacecraftState state, double[] parameters)Compute acceleration.Vector3DLenseThirringRelativity. acceleration(SpacecraftState s, double[] parameters)Compute acceleration.Vector3DNewtonianAttraction. acceleration(SpacecraftState s, double[] parameters)Compute acceleration.Vector3DOceanTides. acceleration(SpacecraftState s, double[] parameters)Compute acceleration.Vector3DRelativity. acceleration(SpacecraftState s, double[] parameters)Compute acceleration.Vector3DSingleBodyAbsoluteAttraction. acceleration(SpacecraftState s, double[] parameters)Compute acceleration.Vector3DSingleBodyRelativeAttraction. acceleration(SpacecraftState s, double[] parameters)Compute acceleration.Vector3DSolidTides. acceleration(SpacecraftState s, double[] parameters)Compute acceleration.Vector3DThirdBodyAttraction. acceleration(SpacecraftState s, double[] parameters)Compute acceleration.voidNewtonianAttraction. 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 Vector3DInertialForces. 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 SpacecraftStateSmallManeuverAnalyticalModel. 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 Vector3DManeuver. acceleration(SpacecraftState s, double[] parameters)voidManeuver. addContribution(SpacecraftState s, TimeDerivativesEquations adder)Compute the contribution of the force model to the perturbing acceleration.SpacecraftStateSmallManeuverAnalyticalModel. apply(SpacecraftState state1)Compute the effect of the maneuver on a spacecraft state.doubleImpulseManeuver. g(SpacecraftState s)Compute the value of the switching function.voidImpulseManeuver. init(SpacecraftState s0, AbsoluteDate t)Initialize event handler at the start of a propagation.voidManeuver. init(SpacecraftState initialState, AbsoluteDate target)Initialize the force model at the start of propagation.booleanConstantThrustManeuver. 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 SpacecraftStateTriggerDate. 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 CombinedDerivativesMassDepletionDelay. 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.voidMassDepletionDelay. init(SpacecraftState initialState, AbsoluteDate target)Initialize the generator at the start of propagation.voidTriggerDate. init(SpacecraftState initialState, AbsoluteDate target)Initialize the additional state provider at the start of propagation.voidTriggerDate. maneuverTriggered(SpacecraftState state, boolean start)Observe a maneuver trigger.SpacecraftStateTriggerDate. resetState(SpacecraftState state)Reset state as a maneuver triggers.booleanDuration. yields(SpacecraftState state)Check if this provider should yield so another provider has an opportunity to add missing parts.booleanMedianDate. yields(SpacecraftState state)Check if this provider should yield so another provider has an opportunity to add missing parts.booleanTriggerDate. 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 Vector3DPropulsionModel. getAcceleration(SpacecraftState s, Attitude maneuverAttitude, double[] parameters)Get the acceleration of the spacecraft during maneuver and in maneuver frame.default Vector3DThrustPropulsionModel. getAcceleration(SpacecraftState s, Attitude maneuverAttitude, double[] parameters)Get the acceleration of the spacecraft during maneuver and in maneuver frame.default Vector3DThrustPropulsionModel. getDirection(SpacecraftState s)Get the thrust direction in spacecraft frame.doubleAbstractConstantThrustPropulsionModel. getFlowRate(SpacecraftState s)Get the flow rate (kg/s).doubleAbstractConstantThrustPropulsionModel. getFlowRate(SpacecraftState s, double[] parameters)Get the flow rate (kg/s).doubleProfileThrustPropulsionModel. getFlowRate(SpacecraftState s)Get the flow rate (kg/s).doubleProfileThrustPropulsionModel. getFlowRate(SpacecraftState s, double[] parameters)Get the flow rate (kg/s).doubleThrustPropulsionModel. getFlowRate(SpacecraftState s)Get the flow rate (kg/s).doubleThrustPropulsionModel. getFlowRate(SpacecraftState s, double[] parameters)Get the flow rate (kg/s).default doubleThrustPropulsionModel. getIsp(SpacecraftState s)Get the specific impulse (s).doublePropulsionModel. getMassDerivatives(SpacecraftState s, double[] parameters)Get the mass derivative (i.e.default doubleThrustPropulsionModel. getMassDerivatives(SpacecraftState s, double[] parameters)Get the mass derivative (i.e.Vector3DAbstractConstantThrustPropulsionModel. getThrustVector(SpacecraftState s)Get the thrust vector in spacecraft frame (N).Vector3DAbstractConstantThrustPropulsionModel. getThrustVector(SpacecraftState s, double[] parameters)Get the thrust vector in spacecraft frame (N).Vector3DProfileThrustPropulsionModel. getThrustVector(SpacecraftState s)Get the thrust vector in spacecraft frame (N).Vector3DProfileThrustPropulsionModel. getThrustVector(SpacecraftState s, double[] parameters)Get the thrust vector in spacecraft frame (N).Vector3DThrustPropulsionModel. getThrustVector(SpacecraftState s)Get the thrust vector in spacecraft frame (N).Vector3DThrustPropulsionModel. getThrustVector(SpacecraftState s, double[] parameters)Get the thrust vector in spacecraft frame (N).default voidPropulsionModel. 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 SpacecraftStateAbstractManeuverTriggers. applyResetters(SpacecraftState state)Apply resetters.SpacecraftStateManeuverTriggersResetter. 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 SpacecraftStateAbstractManeuverTriggers. applyResetters(SpacecraftState state)Apply resetters.voidAbstractManeuverTriggers. init(SpacecraftState initialState, AbsoluteDate target)Initialization method called at propagation start.voidIntervalEventTrigger. init(SpacecraftState initialState, AbsoluteDate target)Initialization method called at propagation start.default voidManeuverTriggers. init(SpacecraftState initialState, AbsoluteDate target)Initialization method called at propagation start.default voidManeuverTriggersResetter. init(SpacecraftState initialState, AbsoluteDate target)Initialization method called at propagation start.voidStartStopEventsTrigger. init(SpacecraftState initialState, AbsoluteDate target)Initialization method called at propagation start.protected voidAbstractManeuverTriggers. initializeResetters(SpacecraftState initialState, AbsoluteDate target)Initialize resetters.protected abstract booleanAbstractManeuverTriggers. isFiringOnInitialState(SpacecraftState initialState, boolean isForward)Method to check if the thruster is firing on initialization.protected booleanIntervalEventTrigger. isFiringOnInitialState(SpacecraftState initialState, boolean isForward)Method to check if the thruster is firing on initialization.protected booleanStartStopEventsTrigger. isFiringOnInitialState(SpacecraftState initialState, boolean isForward)Method to check if the thruster is firing on initialization.voidManeuverTriggersResetter. maneuverTriggered(SpacecraftState state, boolean start)Observe a maneuver trigger.protected voidAbstractManeuverTriggers. notifyResetters(SpacecraftState state, boolean start)Notify resetters.SpacecraftStateManeuverTriggersResetter. 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 Vector3DECOM2. acceleration(SpacecraftState s, double[] parameters)Compute acceleration.Vector3DKnockeRediffusedForceModel. acceleration(SpacecraftState s, double[] parameters)Compute acceleration.Vector3DRadiationPressureModel. acceleration(SpacecraftState s, double[] parameters)Compute acceleration.Vector3DSolarRadiationPressure. acceleration(SpacecraftState s, double[] parameters)Compute acceleration.Vector3DKnockeRediffusedForceModel. computeElementaryFlux(SpacecraftState state, Vector3D elementCenter, Vector3D sunPosition, OneAxisEllipsoid earth, double elementArea)Compute elementary rediffused flux on satellite.Vector3DAbstractLightFluxModel. getLightFluxVector(SpacecraftState state)Get the light flux vector in the state's frame.Vector3DLightFluxModel. getLightFluxVector(SpacecraftState state)Get the light flux vector in the state's frame.doubleSolarRadiationPressure. getLightingRatio(SpacecraftState state)Get the lighting ratio ([0-1]).Vector3DIsotropicRadiationClassicalConvention. radiationPressureAcceleration(SpacecraftState state, Vector3D flux, double[] parameters)Compute the acceleration due to radiation pressure.Vector3DIsotropicRadiationCNES95Convention. radiationPressureAcceleration(SpacecraftState state, Vector3D flux, double[] parameters)Compute the acceleration due to radiation pressure.Vector3DIsotropicRadiationSingleCoefficient. radiationPressureAcceleration(SpacecraftState state, Vector3D flux, double[] parameters)Compute the acceleration due to radiation pressure.Vector3DRadiationSensitive. 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 doubleEstimatedIonosphericModel. 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.doubleGlobalIonosphereMapModel. pathDelay(SpacecraftState state, TopocentricFrame baseFrame, double frequency, double[] parameters)doubleIonosphericModel. 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.doubleKlobucharIonoModel. 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.doubleNeQuickModel. pathDelay(SpacecraftState state, TopocentricFrame baseFrame, double frequency, double[] parameters)doubleSsrVtecIonosphericModel. 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 PVCoordinatesLibrationOrbit. 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 SpacecraftStateSpacecraftState. addAdditionalState(String name, double... value)Add an additional state.SpacecraftStateSpacecraftState. addAdditionalStateDerivative(String name, double... value)Add an additional state derivative.abstract SpacecraftStateAbstractStateModifier. change(SpacecraftState state)Change main state.SpacecraftStateAbstractPropagator. getInitialState()Get the propagator initial state.SpacecraftStatePropagator. getInitialState()Get the propagator initial state.SpacecraftStateSpacecraftStateInterpolator. interpolate(AbsoluteDate interpolationDate, Collection<SpacecraftState> sample)Get an interpolated instance.protected SpacecraftStateSpacecraftStateInterpolator. interpolate(AbstractTimeInterpolator.InterpolationData interpolationData)Interpolate instance from given interpolation data.SpacecraftStateAbstractPropagator. propagate(AbsoluteDate target)Propagate towards a target date.SpacecraftStatePropagator. propagate(AbsoluteDate target)Propagate towards a target date.SpacecraftStatePropagator. propagate(AbsoluteDate start, AbsoluteDate target)Propagate from a start date towards a target date.SpacecraftStateSpacecraftState. shiftedBy(double dt)Get a time-shifted state.SpacecraftStateFieldSpacecraftState. toSpacecraftState()To convert a FieldSpacecraftState instance into a SpacecraftState instance.SpacecraftStateAbstractStateModifier. update(SpacecraftState state)Update a state.default SpacecraftStateAdditionalStateProvider. update(SpacecraftState state)Update a state.protected SpacecraftStateAbstractPropagator. updateAdditionalStates(SpacecraftState original)Update state by adding all additional states.protected SpacecraftStateAbstractPropagator. 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 SpacecraftStateAbstractStateModifier. change(SpacecraftState state)Change main state.voidSpacecraftState. 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.RealMatrixAbstractMatricesHarvester. getParametersJacobian(SpacecraftState state)Get the Jacobian with respect to propagation parameters.RealMatrixMatricesHarvester. getParametersJacobian(SpacecraftState state)Get the Jacobian with respect to propagation parameters.StateCovarianceStateCovarianceMatrixProvider. getStateCovariance(SpacecraftState state)Get the state covariance in the same frame/local orbital frame, orbit type and position angle as the initial covariance.StateCovarianceStateCovarianceMatrixProvider. getStateCovariance(SpacecraftState state, Frame frame)Get the state covariance expressed in a given frame.StateCovarianceStateCovarianceMatrixProvider. getStateCovariance(SpacecraftState state, OrbitType orbitType, PositionAngleType angleType)Get the state covariance expressed in a given orbit type.RealMatrixAbstractMatricesHarvester. getStateTransitionMatrix(SpacecraftState state)Extract state transition matrix from state.RealMatrixMatricesHarvester. getStateTransitionMatrix(SpacecraftState state)Extract state transition matrix from state.default voidAdditionalStateProvider. init(SpacecraftState initialState, AbsoluteDate target)Initialize the additional state provider at the start of propagation.voidStateCovarianceMatrixProvider. init(SpacecraftState initialState, AbsoluteDate target)Initialize the additional state provider at the start of propagation.voidAbstractPropagator. resetInitialState(SpacecraftState state)Reset the propagator initial state.voidPropagator. resetInitialState(SpacecraftState state)Reset the propagator initial state.voidAbstractMatricesHarvester. setReferenceState(SpacecraftState reference)Set up reference state.voidMatricesHarvester. setReferenceState(SpacecraftState reference)Set up reference state.protected voidAbstractPropagator. stateChanged(SpacecraftState state)Notify about a state change.SpacecraftStateAbstractStateModifier. update(SpacecraftState state)Update a state.default SpacecraftStateAdditionalStateProvider. update(SpacecraftState state)Update a state.protected SpacecraftStateAbstractPropagator. updateAdditionalStates(SpacecraftState original)Update state by adding all additional states.protected SpacecraftStateAbstractPropagator. updateUnmanagedStates(SpacecraftState original)Update state by adding unmanaged states.default booleanAdditionalStateProvider. yields(SpacecraftState state)Check if this provider should yield so another provider has an opportunity to add missing parts.booleanStateCovarianceMatrixProvider. 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 voidSpacecraftStateInterpolator. checkSampleAndInterpolatorConsistency(List<SpacecraftState> sample, boolean orbitInterpolatorIsPresent, boolean absPVInterpolatorIsPresent)Check that an interpolator exist for given sample state definition.static voidSpacecraftStateInterpolator. checkStatesDefinitionsConsistency(List<SpacecraftState> states)Check that all state are either orbit defined or based on absolute position-velocity-acceleration.SpacecraftStateSpacecraftStateInterpolator. 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 SpacecraftStateAbstractAnalyticalPropagator. acceptStep(OrekitStepInterpolator interpolator, AbsoluteDate target)Accept a step, triggering events and step handlers.SpacecraftStateAdapterPropagator.DifferentialEffect. apply(SpacecraftState original)Apply the effect to aspacecraft state.SpacecraftStateJ2DifferentialEffect. apply(SpacecraftState state1)Apply the effect to aspacecraft state.protected SpacecraftStateAbstractAnalyticalPropagator. basicPropagate(AbsoluteDate date)Propagate an orbit without any fancy features.protected SpacecraftStateAdapterPropagator. basicPropagate(AbsoluteDate date)Propagate an orbit without any fancy features.protected SpacecraftStateAggregateBoundedPropagator. basicPropagate(AbsoluteDate date)SpacecraftStateEphemeris. basicPropagate(AbsoluteDate date)Propagate an orbit without any fancy features.SpacecraftStateAdapterPropagator. getInitialState()Get the propagator initial state.SpacecraftStateAggregateBoundedPropagator. getInitialState()SpacecraftStateEphemeris. getInitialState()Get the propagator initial state.SpacecraftStateAbstractAnalyticalPropagator. 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 SpacecraftStateAdapterPropagator.DifferentialEffect. apply(SpacecraftState original)Apply the effect to aspacecraft state.SpacecraftStateJ2DifferentialEffect. apply(SpacecraftState state1)Apply the effect to aspacecraft state.double[]AbstractAnalyticalMatricesHarvester. getAdditionalState(SpacecraftState state)Get the additional state.RealMatrixAbstractAnalyticalMatricesHarvester. getParametersJacobian(SpacecraftState state)Get the Jacobian with respect to propagation parameters.RealMatrixAbstractAnalyticalMatricesHarvester. getStateTransitionMatrix(SpacecraftState state)Extract state transition matrix from state.voidAdapterPropagator. resetInitialState(SpacecraftState state)Reset the propagator initial state.voidAggregateBoundedPropagator. resetInitialState(SpacecraftState state)voidBrouwerLyddanePropagator. resetInitialState(SpacecraftState state)Reset the propagator initial state.voidBrouwerLyddanePropagator. resetInitialState(SpacecraftState state, PropagationType stateType)Reset the propagator initial state.voidBrouwerLyddanePropagator. resetInitialState(SpacecraftState state, PropagationType stateType, double epsilon, int maxIterations)Reset the propagator initial state.voidEcksteinHechlerPropagator. resetInitialState(SpacecraftState state)Reset the propagator initial state.voidEcksteinHechlerPropagator. resetInitialState(SpacecraftState state, PropagationType stateType)Reset the propagator initial state.voidEcksteinHechlerPropagator. resetInitialState(SpacecraftState state, PropagationType stateType, double epsilon, int maxIterations)Reset the propagator initial state.voidEphemeris. resetInitialState(SpacecraftState state)Try (and fail) to reset the initial state.voidKeplerianPropagator. resetInitialState(SpacecraftState state)Reset the propagator initial state.protected abstract voidAbstractAnalyticalPropagator. resetIntermediateState(SpacecraftState state, boolean forward)Reset an intermediate state.protected voidAdapterPropagator. resetIntermediateState(SpacecraftState state, boolean forward)Reset an intermediate state.protected voidAggregateBoundedPropagator. resetIntermediateState(SpacecraftState state, boolean forward)protected voidBrouwerLyddanePropagator. resetIntermediateState(SpacecraftState state, boolean forward)Reset an intermediate state.protected voidBrouwerLyddanePropagator. resetIntermediateState(SpacecraftState state, boolean forward, double epsilon, int maxIterations)Reset an intermediate state.protected voidEcksteinHechlerPropagator. resetIntermediateState(SpacecraftState state, boolean forward)Reset an intermediate state.protected voidEcksteinHechlerPropagator. resetIntermediateState(SpacecraftState state, boolean forward, double epsilon, int maxIterations)Reset an intermediate state.protected voidEphemeris. resetIntermediateState(SpacecraftState state, boolean forward)Reset an intermediate state.protected voidKeplerianPropagator. resetIntermediateState(SpacecraftState state, boolean forward)Reset an intermediate state.voidAbstractAnalyticalMatricesHarvester. 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 voidEphemeris. 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 voidEphemeris. 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 voidEphemeris. 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.voidGLONASSAnalyticalPropagator. resetInitialState(SpacecraftState state)Reset the propagator initial state.voidGNSSPropagator. resetInitialState(SpacecraftState state)Reset the propagator initial state.voidSBASPropagator. resetInitialState(SpacecraftState state)Reset the propagator initial state.protected voidGLONASSAnalyticalPropagator. resetIntermediateState(SpacecraftState state, boolean forward)Reset an intermediate state.protected voidGNSSPropagator. resetIntermediateState(SpacecraftState state, boolean forward)Reset an intermediate state.protected voidSBASPropagator. 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 voidIntelsatElevenElementsPropagator. resetInitialState(SpacecraftState state)Reset the propagator initial state.protected voidIntelsatElevenElementsPropagator. 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 voidTLEPropagator. resetInitialState(SpacecraftState state)Reset the propagator initial state.protected voidTLEPropagator. resetIntermediateState(SpacecraftState state, boolean forward)Reset an intermediate state.static TLETLE. 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 TLEFixedPointTleGenerationAlgorithm. generate(SpacecraftState state, TLE templateTLE)Generate a TLE from a given spacecraft state and a template TLE.TLELeastSquaresTleGenerationAlgorithm. generate(SpacecraftState state, TLE templateTLE)Generate a TLE from a given spacecraft state and a template TLE.TLETleGenerationAlgorithm. 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 SpacecraftStateOsculatingToMeanElementsConverter. 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 PropagatorAbstractPropagatorConverter. convert(List<SpacecraftState> states, boolean positionOnly, String... freeParameters)Find the propagator that minimize the mean square error for a sample ofstates.PropagatorAbstractPropagatorConverter. convert(List<SpacecraftState> states, boolean positionOnly, List<String> freeParameters)Find the propagator that minimize the mean square error for a sample ofstates.PropagatorPropagatorConverter. convert(List<SpacecraftState> states, boolean positionOnly, String... freeParameters)Find the propagator that minimize the mean square error for a sample ofstates.PropagatorPropagatorConverter. 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 SpacecraftStateEventState.EventOccurrence. getNewState()Get the new state for a reset action.SpacecraftStateEventsLogger.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 doubleBetaAngleDetector. calculateBetaAngle(SpacecraftState state, PVCoordinatesProvider celestialBodyProvider)Calculate the beta angle between the orbit plane and the celestial body.static doubleBetaAngleDetector. calculateBetaAngle(SpacecraftState state, PVCoordinatesProvider celestialBodyProvider, Frame frame)Calculate the beta angle between the orbit plane and the celestial body.PVCoordinatesExtremumApproachDetector. 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)doubleAdaptableInterval. currentInterval(SpacecraftState state)Get the current value of maximal time interval between events handler checks.EventState.EventOccurrenceEventState. doEvent(SpacecraftState state)Notify the user's listener of the event.booleanEnablingPredicate. eventIsEnabled(SpacecraftState state, EventDetector detector, double g)Compute an event enabling function of state.abstract doubleAbstractDetector. g(SpacecraftState s)Compute the value of the switching function.doubleAdapterDetector. g(SpacecraftState s)Compute the value of the switching function.doubleAlignmentDetector. g(SpacecraftState s)Compute the value of the switching function.doubleAltitudeDetector. g(SpacecraftState s)Compute the value of the switching function.doubleAngularSeparationDetector. g(SpacecraftState s)Compute the value of the switching function.doubleAngularSeparationFromSatelliteDetector. g(SpacecraftState s)Compute the value of the switching function.doubleApsideDetector. g(SpacecraftState s)Compute the value of the switching function.doubleBetaAngleDetector. g(SpacecraftState s)Compute the value of the switching function.doubleBooleanDetector. g(SpacecraftState s)doubleCylindricalShadowEclipseDetector. g(SpacecraftState s)Compute the value of the switching function.doubleDateDetector. g(SpacecraftState s)Compute the value of the switching function.doubleEclipseDetector. g(SpacecraftState s)Compute the value of the switching function.doubleElevationDetector. g(SpacecraftState s)Compute the value of the switching function.doubleElevationExtremumDetector. g(SpacecraftState s)Compute the value of the detection function.doubleEventDetector. g(SpacecraftState s)Compute the value of the switching function.doubleEventEnablingPredicateFilter. g(SpacecraftState s)Compute the value of the switching function.doubleEventShifter. g(SpacecraftState s)Compute the value of the switching function.doubleEventSlopeFilter. g(SpacecraftState s)Compute the value of the switching function.doubleExtremumApproachDetector. g(SpacecraftState s)Thegis positive when the primary object is getting further away from the secondary object and is negative when it is getting closer to it.doubleFieldOfViewDetector. g(SpacecraftState s)Compute the value of the switching function.doubleFootprintOverlapDetector. g(SpacecraftState s)Compute the value of the switching function.doubleFunctionalDetector. g(SpacecraftState s)doubleGeographicZoneDetector. g(SpacecraftState s)Compute the value of the detection function.doubleGroundAtNightDetector. g(SpacecraftState state)Compute the value of the switching function.doubleGroundFieldOfViewDetector. g(SpacecraftState s)Compute the value of the switching function.doubleHaloXZPlaneCrossingDetector. g(SpacecraftState s)Compute the value of the detection function.doubleInterSatDirectViewDetector. g(SpacecraftState state)Compute the value of the switching function.doubleLatitudeCrossingDetector. g(SpacecraftState s)Compute the value of the detection function.doubleLatitudeExtremumDetector. g(SpacecraftState s)Compute the value of the detection function.doubleLatitudeRangeCrossingDetector. g(SpacecraftState s)Compute the value of the detection function.doubleLongitudeCrossingDetector. g(SpacecraftState s)Compute the value of the detection function.doubleLongitudeExtremumDetector. g(SpacecraftState s)Compute the value of the detection function.doubleLongitudeRangeCrossingDetector. g(SpacecraftState s)Compute the value of the detection function.doubleMagneticFieldDetector. g(SpacecraftState s)Compute the value of the detection function.doubleNegateDetector. g(SpacecraftState s)doubleNodeDetector. g(SpacecraftState s)Compute the value of the switching function.doubleParameterDrivenDateIntervalDetector. g(SpacecraftState s)Compute the value of the switching function.doublePositionAngleDetector. g(SpacecraftState s)Compute the value of the detection function.doubleRelativeDistanceDetector. g(SpacecraftState s)Thegis positive when the relative distance is larger or equal than the threshold, non-positive otherwise.doubleElevationExtremumDetector. getElevation(SpacecraftState s)Get the elevation value.voidAbstractDetector. init(SpacecraftState s0, AbsoluteDate t)Initialize event handler at the start of a propagation.voidAdapterDetector. init(SpacecraftState s0, AbsoluteDate t)Initialize event handler at the start of a propagation.voidBooleanDetector. init(SpacecraftState s0, AbsoluteDate t)default voidEventDetector. init(SpacecraftState s0, AbsoluteDate t)Initialize event handler at the start of a propagation.voidEventEnablingPredicateFilter. init(SpacecraftState s0, AbsoluteDate t)Initialize event handler at the start of a propagation.voidEventShifter. init(SpacecraftState s0, AbsoluteDate t)Initialize event handler at the start of a propagation.voidEventSlopeFilter. init(SpacecraftState s0, AbsoluteDate t)Initialize event handler at the start of a propagation.voidEventState. init(SpacecraftState s0, AbsoluteDate t)Initialize event handler at the start of a propagation.voidLongitudeCrossingDetector. init(SpacecraftState s0, AbsoluteDate t)Initialize event handler at the start of a propagation.voidMagneticFieldDetector. init(SpacecraftState s0, AbsoluteDate t)Initialize event handler at the start of a propagation.voidNegateDetector. init(SpacecraftState s0, AbsoluteDate t)voidPositionAngleDetector. init(SpacecraftState s0, AbsoluteDate t)Initialize event handler at the start of a propagation.booleanEventState. 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 FunctionalDetectorFunctionalDetector. 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 SpacecraftStateRecordAndContinue.Event. getState()Get the spacecraft's state at the event.default SpacecraftStateEventHandler. resetState(EventDetector detector, SpacecraftState oldState)Reset the state prior to continue propagation.SpacecraftStateEventMultipleHandler. resetState(EventDetector detector, SpacecraftState oldState)Reset the state prior to continue propagation.SpacecraftStateRecallLastOccurrence. 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 ActionContinueOnEvent. eventOccurred(SpacecraftState s, EventDetector detector, boolean increasing)Specific implementation of the eventOccurred interface.ActionEventHandler. eventOccurred(SpacecraftState s, EventDetector detector, boolean increasing)Handle an event.ActionEventMultipleHandler. eventOccurred(SpacecraftState s, EventDetector detector, boolean increasing)Handle an event.ActionRecallLastOccurrence. eventOccurred(SpacecraftState s, EventDetector detector, boolean increasing)Handle an event.ActionRecordAndContinue. eventOccurred(SpacecraftState s, EventDetector detector, boolean increasing)ActionStopOnDecreasing. eventOccurred(SpacecraftState s, EventDetector detector, boolean increasing)Handle a detection event and choose what to do next.ActionStopOnEvent. eventOccurred(SpacecraftState s, EventDetector detector, boolean increasing)Specific implementation of the eventOccurred interface.ActionStopOnIncreasing. eventOccurred(SpacecraftState s, EventDetector detector, boolean increasing)Handle a detection event and choose what to do next.default voidEventHandler. init(SpacecraftState initialState, AbsoluteDate target, EventDetector detector)Initialize event handler at the start of a propagation.voidEventMultipleHandler. init(SpacecraftState initialState, AbsoluteDate target, EventDetector detector)Initialize event handler at the start of a propagation.voidRecallLastOccurrence. init(SpacecraftState initialState, AbsoluteDate target, EventDetector detector)Initialize event handler at the start of a propagation.default SpacecraftStateEventHandler. resetState(EventDetector detector, SpacecraftState oldState)Reset the state prior to continue propagation.SpacecraftStateEventMultipleHandler. resetState(EventDetector detector, SpacecraftState oldState)Reset the state prior to continue propagation.SpacecraftStateRecallLastOccurrence. 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 SpacecraftStateIntegratedEphemeris. basicPropagate(AbsoluteDate date)Propagate an orbit without any fancy features.protected SpacecraftStateAbstractIntegratedPropagator. getInitialIntegrationState()Get the initial state for integration.SpacecraftStateIntegratedEphemeris. getInitialState()Get the propagator initial state.SpacecraftStateStateMapper. mapArrayToState(double t, double[] y, double[] yDot, PropagationType type)Map the raw double components to a spacecraft state.abstract SpacecraftStateStateMapper. mapArrayToState(AbsoluteDate date, double[] y, double[] yDot, PropagationType type)Map the raw double components to a spacecraft state.SpacecraftStateAbstractIntegratedPropagator. propagate(AbsoluteDate target)Propagate towards a target date.SpacecraftStateAbstractIntegratedPropagator. propagate(AbsoluteDate tStart, AbsoluteDate tEnd)Propagate from a start date towards a target date.protected SpacecraftStateIntegratedEphemeris. 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 voidAbstractIntegratedPropagator. 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.CombinedDerivativesAdditionalDerivativesProvider. 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 voidAbstractIntegratedPropagator.MainStateEquations. init(SpacecraftState initialState, AbsoluteDate target)Initialize the equations at the start of propagation.default voidAdditionalDerivativesProvider. init(SpacecraftState initialState, AbsoluteDate target)Initialize the generator at the start of propagation.abstract voidStateMapper. mapStateToArray(SpacecraftState state, double[] y, double[] yDot)Map a spacecraft state to raw double components.voidIntegratedEphemeris. resetInitialState(SpacecraftState state)Reset the propagator initial state.protected voidIntegratedEphemeris. resetIntermediateState(SpacecraftState state, boolean forward)Reset an intermediate state.protected SpacecraftStateIntegratedEphemeris. updateAdditionalStates(SpacecraftState original)Update state by adding all additional states.default booleanAdditionalDerivativesProvider. 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 SpacecraftStateGLONASSNumericalPropagator. propagate(AbsoluteDate date)Propagate towards a target date.SpacecraftStateEpochDerivativesEquations. setInitialJacobians(SpacecraftState s0)Set the initial value of the Jacobian with respect to state and parameter.SpacecraftStateEpochDerivativesEquations. 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 voidNumericalPropagator. beforeIntegration(SpacecraftState initialState, AbsoluteDate tEnd)Method called just before integration.CombinedDerivativesEpochDerivativesEquations. combinedDerivatives(SpacecraftState s)Compute the derivatives related to the additional state (and optionally main state increments).voidNumericalPropagator. resetInitialState(SpacecraftState state)Reset the propagator initial state.SpacecraftStateEpochDerivativesEquations. setInitialJacobians(SpacecraftState s0)Set the initial value of the Jacobian with respect to state and parameter.SpacecraftStateEpochDerivativesEquations. setInitialJacobians(SpacecraftState s1, double[][] dY1dY0, double[][] dY1dP)Set the initial value of the Jacobian with respect to state and parameter.voidEpochDerivativesEquations. setInitialJacobians(SpacecraftState state, double[][] dY1dY0, double[][] dY1dP, double[] p)Set the Jacobian with respect to state into a one-dimensional additional state array.voidNumericalPropagator. 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 SpacecraftStateCR3BPMultipleShooter. getAugmentedInitialState(int i)Compute the additional state from the additionalEquations.SpacecraftStateSTMEquations. 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 Vector3DCR3BPForceModel. acceleration(SpacecraftState s, double[] parameters)Compute acceleration.CombinedDerivativesSTMEquations. combinedDerivatives(SpacecraftState s)Compute the derivatives related to the additional state (and optionally main state increments).DerivativeStructureCR3BPForceModel. getPotential(SpacecraftState s)Calculate spacecraft potential.RealMatrixSTMEquations. getStateTransitionMatrix(SpacecraftState s)Method returning the State Transition Matrix.SpacecraftStateSTMEquations. 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 SpacecraftStateOrekitStepInterpolator. getCurrentState()Get the state at current grid point date.SpacecraftStateOrekitStepInterpolator. getInterpolatedState(AbsoluteDate date)Get the state at interpolated date.SpacecraftStateOrekitStepInterpolator. 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 voidOrekitFixedStepHandler. finish(SpacecraftState finalState)Finalize propagation.default voidOrekitStepHandler. finish(SpacecraftState finalState)Finalize propagation.voidOrekitStepNormalizer. finish(SpacecraftState finalState)Finalize propagation.voidStepHandlerMultiplexer. finish(SpacecraftState finalState)Finalize propagation.voidOrekitFixedStepHandler. handleStep(SpacecraftState currentState)Handle the current step.default voidOrekitFixedStepHandler. init(SpacecraftState s0, AbsoluteDate t, double step)Initialize step handler at the start of a propagation.default voidOrekitStepHandler. init(SpacecraftState s0, AbsoluteDate t)Initialize step handler at the start of a propagation.voidOrekitStepNormalizer. init(SpacecraftState s0, AbsoluteDate t)Initialize step handler at the start of a propagation.voidStepHandlerMultiplexer. init(SpacecraftState s0, AbsoluteDate t)Initialize step handler at the start of a propagation.OrekitStepInterpolatorOrekitStepInterpolator. 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 voidMultiSatFixedStepHandler. finish(List<SpacecraftState> finalStates)Finalize propagation.default voidMultiSatStepHandler. finish(List<SpacecraftState> finalStates)Finalize propagation.voidMultisatStepNormalizer. finish(List<SpacecraftState> finalStates)Finalize propagation.voidMultiSatFixedStepHandler. handleStep(List<SpacecraftState> states)Handle the current step.default voidMultiSatFixedStepHandler. init(List<SpacecraftState> states0, AbsoluteDate t, double step)Initialize step handler at the start of a propagation.default voidMultiSatStepHandler. init(List<SpacecraftState> states0, AbsoluteDate t)Initialize step handler at the start of a propagation.voidMultisatStepNormalizer. 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 SpacecraftStateDSSTPropagator. computeMeanState(SpacecraftState osculating, AttitudeProvider attitudeProvider, Collection<DSSTForceModel> forceModels)Conversion from osculating to mean orbit.static SpacecraftStateDSSTPropagator. computeMeanState(SpacecraftState osculating, AttitudeProvider attitudeProvider, Collection<DSSTForceModel> forceModels, double epsilon, int maxIterations)Conversion from osculating to mean orbit.static SpacecraftStateDSSTPropagator. computeOsculatingState(SpacecraftState mean, AttitudeProvider attitudeProvider, Collection<DSSTForceModel> forces)Conversion from mean to osculating orbit.protected SpacecraftStateDSSTPropagator. 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 voidDSSTPropagator. beforeIntegration(SpacecraftState initialState, AbsoluteDate tEnd)Method called just before integration.static SpacecraftStateDSSTPropagator. computeMeanState(SpacecraftState osculating, AttitudeProvider attitudeProvider, Collection<DSSTForceModel> forceModels)Conversion from osculating to mean orbit.static SpacecraftStateDSSTPropagator. computeMeanState(SpacecraftState osculating, AttitudeProvider attitudeProvider, Collection<DSSTForceModel> forceModels, double epsilon, int maxIterations)Conversion from osculating to mean orbit.static SpacecraftStateDSSTPropagator. computeOsculatingState(SpacecraftState mean, AttitudeProvider attitudeProvider, Collection<DSSTForceModel> forces)Conversion from mean to osculating orbit.RealMatrixDSSTHarvester. getB2(SpacecraftState state)Get the Jacobian matrix B2 (B2 = ∂Y/∂Y₀).RealMatrixDSSTHarvester. getB3(SpacecraftState state)Get the Jacobian matrix B3 (B3 = ∂Y/∂P).RealMatrixDSSTHarvester. getParametersJacobian(SpacecraftState state)Get the Jacobian with respect to propagation parameters.double[]DSSTPropagator. getShortPeriodTermsValue(SpacecraftState meanState)Get the short period terms value.RealMatrixDSSTHarvester. getStateTransitionMatrix(SpacecraftState state)Extract state transition matrix from state.voidDSSTHarvester. initializeFieldShortPeriodTerms(SpacecraftState reference)Initialize the short periodic terms for the "field" elements.voidDSSTHarvester. initializeFieldShortPeriodTerms(SpacecraftState reference, PropagationType type)Initialize the short periodic terms for the "field" elements.voidDSSTPropagator. resetInitialState(SpacecraftState state)Reset the initial state.voidDSSTPropagator. setInitialState(SpacecraftState initialState)Set the initial state with osculating orbital elements.voidDSSTPropagator. setInitialState(SpacecraftState initialState, PropagationType stateType)Set the initial state.voidDSSTHarvester. setReferenceState(SpacecraftState reference)Set up reference state.voidDSSTHarvester. 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.SlotAbstractGaussianContribution.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.voidAbstractGaussianContribution. init(SpacecraftState initialState, AbsoluteDate target)Initialize the force model at the start of propagation.default voidDSSTForceModel. init(SpacecraftState initialState, AbsoluteDate target)Initialize the force model at the start of propagation.voidAbstractGaussianContribution. updateShortPeriodTerms(double[] parameters, SpacecraftState... meanStates)Update the short period terms.voidDSSTForceModel. updateShortPeriodTerms(double[] parameters, SpacecraftState... meanStates)Update the short period terms.voidDSSTJ2SquaredClosedForm. updateShortPeriodTerms(double[] parameters, SpacecraftState... meanStates)Update the short period terms.voidDSSTNewtonianAttraction. updateShortPeriodTerms(double[] parameters, SpacecraftState... meanStates)Update the short period terms.voidDSSTTesseral. updateShortPeriodTerms(double[] parameters, SpacecraftState... meanStates)Update the short period terms.voidDSSTThirdBody. updateShortPeriodTerms(double[] parameters, SpacecraftState... meanStates)Update the short period terms.voidDSSTZonal. updateShortPeriodTerms(double[] parameters, SpacecraftState... meanStates)Update the 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 SpacecraftStateAbstractMultipleShooting. getAugmentedInitialState(int i)Compute the additional state from the additionalEquations.protected SpacecraftStateMultipleShooter. getAugmentedInitialState(int i)Compute the additional state from the additionalEquations.protected SpacecraftStateAbstractMultipleShooting. 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.OccultationAnglesOccultationEngine. 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.
-