For Sinex::InputHistory.
This is a abstract base class for a clock model
DO NOT EDIT THIS CODE BY HAND.
Refer to the documenation in the toolkit_docs gitlab project.
This is one of four classes designed to contain GPS navigation message data. The classes are
EngEphemeris - Legacy GPS navigation message data from subframes 1,2,3 ( L1 C/A, L1 P(Y), L2 P(Y) )
CNAVEphemeris - GPS Civil navigation message data from Message Type 10/11 (L2C and L5)
CNAVClock - GPS Civil navigation message data from the "clock" portion of Message Types 30-37 (L2C and L5)
CNAV2EphClock - GPS Civil navigation message from subframe 2 of the L1C message
A utility class that contains a pair of CommonTime objects that specify the beginning and end of a time range.
Namespaces | |
bds | |
BinUtils | |
FileUtils | |
galfnav | |
galinav | |
glo | |
gloc | |
gpscnav | |
gpscnav2 | |
gpslnav | |
ord | |
Robust | |
Robust statistics. | |
Sinex | |
StringUtils | |
Functions | |
short | accuracy2CNAVura (double acc) noexcept |
short | accuracy2ura (double acc) noexcept |
double | ADtest (double *xd, const int nd, double m, double s, bool save_flag=true) |
double | ARand (double low, double hi) |
int | ARand (int low, int hi) |
double | beta (double x, double y) |
double | binomialCoeff (int n, int k) |
template<class T , class BaseClass > | |
Matrix< T > | blkdiag (const ConstMatrixBase< T, BaseClass > &m1, const ConstMatrixBase< T, BaseClass > &m2) |
template<class T , class BaseClass > | |
Matrix< T > | blkdiag (const ConstMatrixBase< T, BaseClass > &m1, const ConstMatrixBase< T, BaseClass > &m2, const ConstMatrixBase< T, BaseClass > &m3) |
template<class T , class BaseClass > | |
Matrix< T > | blkdiag (const ConstMatrixBase< T, BaseClass > &m1, const ConstMatrixBase< T, BaseClass > &m2, const ConstMatrixBase< T, BaseClass > &m3, const ConstMatrixBase< T, BaseClass > &m4) |
double | cel2far (double c) |
double | cfIBeta (double x, double a, double b) |
double | ChisqCDF (double x, int n) |
double | ChisqPDF (double x, int n) |
double | compErrorFunc (double x) |
double | compIncompGamma (double a, double x) |
static void | computeFundamentalArgs (double T, double args[6]) |
Triple | computePolarTides (const Position &site, const EphTime &ttag, double xp, double yp, const IERSConvention &iers) |
Triple | computeSolidEarthTides (const Position &site, const EphTime &ttag, const Position &Sun, const Position &Moon, double EMRAT, double SERAT, const IERSConvention &iers) |
template<class T , class BaseClass > | |
T | condNum (const ConstMatrixBase< T, BaseClass > &m) noexcept |
template<class T , class BaseClass > | |
T | condNum (const ConstMatrixBase< T, BaseClass > &m, T &bigNum, T &smallNum) noexcept |
double | contfracIncompGamma (double a, double x) |
long | convertCalendarToJD (int yy, int mm, int dd) |
void | convertJDtoCalendar (long jd, int &iyear, int &imonth, int &iday) |
std::string | convertNavTypeToString (NavType e) |
std::string | convertSatelliteSystemToString (SatelliteSystem s) |
void | convertSODtoTime (double sod, int &hh, int &mm, double &sec) |
NavType | convertStringToNavType (const std::string &s) |
SatelliteSystem | convertStringToSatelliteSystem (const std::string &s) |
double | convertTimeToSOD (int hh, int mm, double sec) |
static void | correctEarthRotationLibrations (const double args[6], double &dUT, double &dld) |
static void | correctEarthRotationZonalTides (const double args[6], double &dUT, double &dld, double &dom) |
static void | correctEarthRotationZonalTides2003 (const double args[6], double &dUT, double &dld, double &dom) |
static void | correctEOPOceanTides (double mjd, double &dxp, double &dyp, double &dUT) |
template<class T , class BaseClass1 , class BaseClass2 > | |
T | cosVec (const ConstVectorBase< T, BaseClass1 > &a, const ConstVectorBase< T, BaseClass2 > &b) |
template<class T > | |
T | cosVec (const SparseVector< T > &S1, const SparseVector< T > &S2) |
template<class T > | |
T | cosVec (const SparseVector< T > &SV, const Vector< T > &V) |
template<class T > | |
T | cosVec (const Vector< T > &V, const SparseVector< T > &SV) |
class BaseClass2 Vector< T > | cross (const ConstVectorBase< T, BaseClass > &l, const ConstVectorBase< T, BaseClass2 > &r) |
void | crudeSolarPosition (const CommonTime &t, double &lat, double &lon) |
double | cycles2meters (double phase, double freq, EllipsoidModel &ellipsoid) |
std::string | demangle (const char *name) |
Demangle G++ class names. More... | |
template<class T , class BaseClass > | |
T | det (const ConstMatrixBase< T, BaseClass > &m) |
template<class T , class BaseClass > | |
Matrix< T > | diag (const ConstMatrixBase< T, BaseClass > &m) |
int | DiscontinuityCorrector (SatPass &SP, GDCconfiguration &config, std::vector< std::string > &EditCmds, std::string &retMsg, int GLOn=-99) |
void | DisplayExtendedRinexObsTypes (ostream &s) |
void | DisplayExtendedRinexObsTypes (std::ostream &s) |
Pretty print a list of registered extended Rinex observation types. More... | |
void | DisplayStandardRinexObsTypes (ostream &s) |
void | DisplayStandardRinexObsTypes (std::ostream &s) |
Pretty print a list of standard Rinex observation types. More... | |
template<class T > | |
void | DMsmootherUpdateWithControl (Matrix< double > &P, Vector< double > &X, Matrix< double > &Phinv, Matrix< double > &Rw, Matrix< double > &G, Vector< double > &Zw, Matrix< double > &Rwx, Vector< double > &U) |
template<class T , class BaseClass , class BaseClass2 > | |
T | dot (const ConstVectorBase< T, BaseClass > &l, const ConstVectorBase< T, BaseClass2 > &r) |
template<class T , class BaseClass > | |
T | dot (const ConstVectorBase< T, BaseClass > &l, const T r) |
template<class T > | |
T | dot (const SparseVector< T > &SL, const SparseVector< T > &SR) |
dot (SparseVector, SparseVector) More... | |
template<class T > | |
T | dot (const SparseVector< T > &SL, const Vector< T > &R) |
dot (SparseVector, Vector) More... | |
template<class T , class BaseClass > | |
T | dot (const T l, const ConstVectorBase< T, BaseClass > &r) |
template<class T > | |
T | dot (const Vector< T > &L, const SparseVector< T > &SR) |
dot (Vector, SparseVector) More... | |
template<class T > | |
T | dot_lim (const SparseVector< T > &SL, const SparseVector< T > &SR, const unsigned int kb, const unsigned int ke) |
dot (SparseVector, SparseVector) but only use indexes k=kb, k<ke More... | |
void | dump (std::vector< SatPass > &SatPassList, std::ostream &os, bool rev=false, bool dbug=false) |
void | dump (vector< SatPass > &SatPassList, ostream &os, bool rev, bool dbug) |
void | dumpAllRinex3ObsTypes (ostream &os) |
void | dumpAllRinex3ObsTypes (std::ostream &s) |
template<typename T > | |
T | errfc (T x) |
double | errorFunc (double x) |
void | expand_args (vector< string > &oldvalues, vector< string > &newvalues, string &msg) |
void | expand_filename (std::string &filename) |
void | expand_filename (std::vector< std::string > &sarray) |
void | expand_filename (string &filename) |
void | expand_filename (vector< string > &sarray) |
bool | expand_list_file (std::string &filename, std::vector< std::string > &values) |
bool | expand_list_file (string &filename, vector< string > &values) |
double | factorial (int n) |
double | far2cel (double f) |
double | FDistCDF (double F, int n1, int n2) |
double | FDistPDF (double x, int n1, int n2) |
int | findMilliseconds (std::vector< SatPass > &SPList, msecHandler &msh) |
int | findMilliseconds (vector< SatPass > &SPList, msecHandler &msh) |
double | Gamma (double x) |
double | getAlpha (SatelliteSystem sys, int na, int nb) noexcept |
double | getBeta (SatelliteSystem sys, int na, int nb) noexcept |
double | getFrequency (CarrierBand band) |
double | getGamma (CarrierBand band1, CarrierBand band2) |
double | getLeapSeconds (const int year, const int month, const double day) |
RefFrameRlz | getRefFrameRlz (RefFrameSys sys, const CommonTime &when) |
RefFrameSys | getRefFrameSys (RefFrameRlz rlz) noexcept |
double | getTimeSystemCorrection (const TimeSystem inTS, const TimeSystem outTS, const int year, const int month, const double day) |
double | getWavelength (SatelliteSystem sys, int rinexBandNum, int gloChan=0) noexcept |
static double | GMST (const CommonTime &t) |
double | hg2mb (double hg) |
template<class T , class BaseClass > | |
BaseClass & | ident (RefMatrixBase< T, BaseClass > &m) |
template<class T > | |
Matrix< T > | ident (size_t dim) |
bool | identical (const Namelist &N1, const Namelist &N2) |
template<class T > | |
SparseMatrix< T > | identSparse (const unsigned int dim) |
void | include_path (std::string path, std::string &file) |
void | include_path (std::string path, std::vector< std::string > &sarray) |
void | include_path (string path, string &file) |
void | include_path (string path, vector< string > &sarray) |
double | incompGamma (double a, double x) |
double | incompleteBeta (double x, double a, double b) |
template<typename T > | |
void | insert (T *sa, int na, int(*comp)(const T &, const T &)=gnsstk::Qsort_compare) |
template<typename T , typename S > | |
void | insert (T *sa, S *pa, int na, int(*comp)(const T &, const T &)=gnsstk::Qsort_compare) |
string | int2bin (unsigned int v, int len=8) |
double | invChisqCDF (double alpha, int n) |
template<class T , class BaseClass > | |
Matrix< T > | inverse (const ConstMatrixBase< T, BaseClass > &m) |
template<class T > | |
SparseMatrix< T > | inverse (const SparseMatrix< T > &A) |
template<class T , class BaseClass > | |
Matrix< T > | inverseChol (const ConstMatrixBase< T, BaseClass > &m) |
template<class T > | |
Matrix< T > | inverseCholesky (const Matrix< T > &A) |
template<class T > | |
Matrix< T > | inverseLT (const Matrix< T > <, T *ptrSmall=NULL, T *ptrBig=NULL) |
template<class T > | |
SparseMatrix< T > | inverseLT (const SparseMatrix< T > &L, T *ptrSmall, T *ptrBig) |
Compute inverse of lower-triangular SparseMatrix. More... | |
template<class T , class BaseClass > | |
Matrix< T > | inverseLUD (const ConstMatrixBase< T, BaseClass > &m) |
template<class T , class BaseClass > | |
Matrix< T > | inverseLUD (const ConstMatrixBase< T, BaseClass > &m, T &determ) |
template<class T , class BaseClass > | |
Matrix< T > | inverseSVD (const ConstMatrixBase< T, BaseClass > &m, const T tol=T(1.e-8)) |
template<class T , class BaseClass > | |
Matrix< T > | inverseSVD (const ConstMatrixBase< T, BaseClass > &m, T &bigNum, T &smallNum, const T tol=T(1.e-8)) |
template<class T , class BaseClass > | |
Matrix< T > | inverseSVD (const ConstMatrixBase< T, BaseClass > &m, Vector< T > &sv, const T tol=T(1.e-8)) |
template<class T > | |
Matrix< T > | inverseUT (const Matrix< T > &UT, T *ptrSmall=NULL, T *ptrBig=NULL) |
template<class T > | |
SparseMatrix< T > | inverseViaCholesky (const SparseMatrix< T > &A) |
double | invFDistCDF (double prob, int n1, int n2) |
double | invNormalCDF (double prob, double mu, double sig) |
double | invStudentsCDF (double prob, int n) |
bool | isRinex3NavFile (const std::string &file) |
bool | isRinex3NavFile (const string &file) |
bool | isRinex3ObsFile (const std::string &file) |
bool | isRinex3ObsFile (const string &file) |
bool | isRinexNavFile (const std::string &file) |
bool | isRinexNavFile (const string &file) |
bool | isRinexObsFile (const std::string &file) |
bool | isRinexObsFile (const string &file) |
bool | isSP3File (const std::string &file) |
bool | isSP3File (const string &file) |
bool | isValidRinexObsID (const std::string &id, const char syschar) |
Determine if the given ObsID is valid, for the given system. More... | |
bool | isValidRinexObsID (const std::string &strID) |
template<class T > | |
T | LagrangeInterpolating2ndDerivative (const std::vector< T > &pos, const std::vector< T > &val, const T desiredPos) |
Returns the second derivative of Lagrange interpolation. More... | |
template<class T > | |
T | LagrangeInterpolation (const std::vector< T > &X, const std::vector< T > &Y, const T &x, T &err) |
template<class T > | |
void | LagrangeInterpolation (const std::vector< T > &X, const std::vector< T > &Y, const T &x, T &y, T &dydx) |
template<class T > | |
Matrix< T > | LDL (const Matrix< T > &A, Vector< T > &D) |
double | lnFactorial (int n) |
double | lnGamma (double x) |
template<class T > | |
Matrix< T > | lowerCholesky (const Matrix< T > &A, const T ztol=T(1.e-16)) |
template<class T > | |
SparseMatrix< T > | lowerCholesky (const SparseMatrix< T > &A) |
Position | lunarPosition (const CommonTime &t, double &AR) |
template<class T > | |
T | mad (const gnsstk::Vector< T > &v) |
median absolute deviation of a gnsstk::Vector More... | |
template<class T > | |
T | mad (const std::vector< T > &v) |
median absolute deviation of a std::vector More... | |
template<class T > | |
SparseMatrix< T > | matrixTimesTranspose (const SparseMatrix< T > &M) |
template<class T , class BaseClass > | |
T | max (const ConstVectorBase< T, BaseClass > &l) |
template<class T > | |
T | max (const SparseMatrix< T > &SM) |
Maximum element - return 0 if empty. More... | |
template<class T > | |
T | max (const SparseVector< T > &SV) |
template<class For > | |
For | max (const std::list< For > &lst) |
A simple way to get the max value of a list of numbers. More... | |
template<class T , class BaseClass > | |
T | maxabs (const ConstMatrixBase< T, BaseClass > &a) noexcept |
template<class T , class BaseClass > | |
T | maxabs (const ConstVectorBase< T, BaseClass > &l) |
template<class T > | |
T | maxabs (const SparseMatrix< T > &SM) |
Maximum absolute value - return 0 if empty. More... | |
template<class T > | |
T | maxabs (const SparseVector< T > &SV) |
double | mb2hg (double mb) |
template<class T > | |
T | median (const std::vector< T > &v) |
Compute the median of a std::vector. More... | |
template<class T > | |
T | median (const Vector< T > &v) |
Compute the median of a gnsstk::Vector. More... | |
double | meters2cycles (double range, double freq, EllipsoidModel &ellipsoid) |
template<class T , class BaseClass > | |
T | min (const ConstVectorBase< T, BaseClass > &l) |
template<class T > | |
T | min (const SparseMatrix< T > &SM) |
Maximum element - return 0 if empty. More... | |
template<class T > | |
T | min (const SparseVector< T > &SV) |
template<class For > | |
For | min (const std::list< For > &lst) |
A simple way to get the minimum value of a list of numbers. More... | |
template<class T , class BaseClass > | |
T | minabs (const ConstVectorBase< T, BaseClass > &l) |
template<class T > | |
T | minabs (const SparseMatrix< T > &SM) |
Minimum absolute value - return 0 if empty. More... | |
template<class T > | |
T | minabs (const SparseVector< T > &SV) |
template<class T , class BaseClass , class BaseClass2 > | |
T | Minkowski (const ConstVectorBase< T, BaseClass > &v, const ConstVectorBase< T, BaseClass2 > &w) |
template<class T , class BaseClass > | |
Matrix< T > | minorMatrix (const ConstMatrixBase< T, BaseClass > &l, size_t row, size_t col) |
void | mixedScanTime (CommonTime &t, const std::string &str, const std::string &fmt) |
void | mixedScanTime (CommonTime &t, const string &str, const string &fmt) |
static double | NB_Interpolate (double lat, int doy, TableEntry entry) |
NEW_EXCEPTION_CLASS (AccessError, Exception) | |
NEW_EXCEPTION_CLASS (AssertionFailure, Exception) | |
NEW_EXCEPTION_CLASS (ConfigurationException, Exception) | |
NEW_EXCEPTION_CLASS (EndOfFile, gnsstk::FFStreamError) | |
NEW_EXCEPTION_CLASS (ExpressionException, Exception) | |
NEW_EXCEPTION_CLASS (FFStreamError, gnsstk::Exception) | |
NEW_EXCEPTION_CLASS (FileMissingException, Exception) | |
NEW_EXCEPTION_CLASS (FileSpecException, gnsstk::Exception) | |
NEW_EXCEPTION_CLASS (GeometryException, gnsstk::Exception) | |
NEW_EXCEPTION_CLASS (IndexOutOfBoundsException, Exception) | |
NEW_EXCEPTION_CLASS (InvalidArgumentException, Exception) | |
NEW_EXCEPTION_CLASS (InvalidParameter, Exception) | |
NEW_EXCEPTION_CLASS (InvalidRequest, Exception) | |
NEW_EXCEPTION_CLASS (InvalidTropModel, gnsstk::Exception) | |
NEW_EXCEPTION_CLASS (InvalidValue, gnsstk::Exception) | |
NEW_EXCEPTION_CLASS (MatrixException, Exception) | |
Thrown when there are problems with the matrix operations. More... | |
NEW_EXCEPTION_CLASS (NoNAVSTARNumberFound, gnsstk::Exception) | |
NEW_EXCEPTION_CLASS (NoPRNNumberFound, gnsstk::Exception) | |
NEW_EXCEPTION_CLASS (NullPointerException, Exception) | |
NEW_EXCEPTION_CLASS (ObjectNotFound, AccessError) | |
NEW_EXCEPTION_CLASS (OutOfMemory, Exception) | |
NEW_EXCEPTION_CLASS (SingularMatrixException, MatrixException) | |
Thrown when an operation can't be performed on a singular matrix. More... | |
NEW_EXCEPTION_CLASS (SVNotPresentException, gnsstk::InvalidRequest) | |
NEW_EXCEPTION_CLASS (SystemPipeException, Exception) | |
NEW_EXCEPTION_CLASS (SystemQueueException, Exception) | |
NEW_EXCEPTION_CLASS (SystemSemaphoreException, Exception) | |
NEW_EXCEPTION_CLASS (UnimplementedException, Exception) | |
NEW_EXCEPTION_CLASS (VectorException, gnsstk::Exception) | |
short | nominalAccuracy2ura (double acc) noexcept |
template<class T , class BaseClass > | |
T | norm (const ConstVectorBase< T, BaseClass > &v) |
template<class T > | |
T | norm (const SparseVector< T > &SV) |
double | NormalCDF (double x, double mu, double sig) |
template<typename T > | |
T | normalCDF (T m, T s, T x) |
template<class T , class BaseClass > | |
Vector< T > | normalize (const ConstVectorBase< T, BaseClass > &l) |
double | NormalPDF (double x, double mu, double sig) |
template<class T , class BaseClass > | |
T | normCol (const ConstMatrixBase< T, BaseClass > &m) |
template<class T , class BaseClass > | |
T | normF (const ConstMatrixBase< T, BaseClass > &m) |
Matrix< double > | northEastUp (Position &pos, bool geocentric) |
Same as upEastNorth(), but with rows re-ordered. More... | |
Matrix< double > | northEastUpGeocentric (Position &pos) |
Same as northEastUp(pos, true). More... | |
Matrix< double > | northEastUpGeodetic (Position &pos) |
Same as northEastUp(pos, false). More... | |
bool | operator!= (const IonexData::IonexValType &x, const IonexData::IonexValType &y) |
operator != for IonexData::IonexValType More... | |
bool | operator!= (const Namelist &N1, const Namelist &N2) |
Namelist | operator& (const Namelist &N1, const Namelist &N2) |
template<class T , class BaseClass1 , class BaseClass2 > | |
Matrix< T > | operator&& (const ConstMatrixBase< T, BaseClass1 > &l, const ConstMatrixBase< T, BaseClass2 > &r) |
template<class T , class BaseClass1 , class BaseClass2 > | |
Matrix< T > | operator&& (const ConstMatrixBase< T, BaseClass1 > &t, const ConstVectorBase< T, BaseClass2 > &b) |
template<class T , class BaseClass1 , class BaseClass2 > | |
Matrix< T > | operator&& (const ConstVectorBase< T, BaseClass1 > &t, const ConstMatrixBase< T, BaseClass2 > &b) |
template<class T , class BaseClass > | |
Matrix< T > | operator* (const ConstMatrixBase< T, BaseClass > &m, const T d) |
Multiplies all the elements of m by d. More... | |
template<class T , class BaseClass1 , class BaseClass2 > | |
Matrix< T > | operator* (const ConstMatrixBase< T, BaseClass1 > &l, const ConstMatrixBase< T, BaseClass2 > &r) |
template<class T , class BaseClass1 , class BaseClass2 > | |
Vector< T > | operator* (const ConstMatrixBase< T, BaseClass1 > &m, const ConstVectorBase< T, BaseClass2 > &v) |
template<class T , class BaseClass1 , class BaseClass2 > | |
Vector< T > | operator* (const ConstVectorBase< T, BaseClass1 > &v, const ConstMatrixBase< T, BaseClass2 > &m) |
template<class T > | |
SparseMatrix< T > | operator* (const Matrix< T > &L, const SparseMatrix< T > &R) |
Matrix multiply: SparseMatrix = Matrix * SparseMatrix. More... | |
template<class T > | |
SparseVector< T > | operator* (const Matrix< T > &L, const SparseVector< T > &V) |
Matrix,Vector multiply: SparseVector = Matrix * SparseVector. More... | |
template<class T > | |
SparseMatrix< T > | operator* (const SparseMatrix< T > &L, const Matrix< T > &R) |
Matrix multiply: SparseMatrix = SparseMatrix * Matrix. More... | |
template<class T > | |
SparseMatrix< T > | operator* (const SparseMatrix< T > &L, const SparseMatrix< T > &R) |
Matrix multiply: SparseMatrix = SparseMatrix * SparseMatrix. More... | |
template<class T > | |
SparseVector< T > | operator* (const SparseMatrix< T > &L, const SparseVector< T > &V) |
Matrix,Vector multiply: SparseVector = SparseMatrix * SparseVector. More... | |
template<class T > | |
SparseVector< T > | operator* (const SparseMatrix< T > &L, const Vector< T > &V) |
Matrix,Vector multiply: SparseVector = SparseMatrix * Vector. More... | |
template<class T > | |
SparseVector< T > | operator* (const SparseVector< T > &V, const Matrix< T > &R) |
Vector,Matrix multiply: SparseVector = SparseVector * Matrix. More... | |
template<class T > | |
SparseVector< T > | operator* (const SparseVector< T > &V, const SparseMatrix< T > &R) |
Vector,Matrix multiply: SparseVector = SparseVector * SparseMatrix. More... | |
template<class T , class BaseClass > | |
Matrix< T > | operator* (const T d, const ConstMatrixBase< T, BaseClass > &m) |
Multiplies all the elements of m by d. More... | |
template<class T > | |
SparseVector< T > | operator* (const Vector< T > &V, const SparseMatrix< T > &R) |
Vector,Matrix multiply: SparseVector = Vector * SparseMatrix. More... | |
Triple | operator* (double scale, const Triple &rhs) |
template<class T , class BaseClass > | |
Matrix< T > | operator+ (const ConstMatrixBase< T, BaseClass > &m, const T d) |
Adds all the elements of m by d. More... | |
template<class T , class BaseClass1 , class BaseClass2 > | |
Matrix< T > | operator+ (const ConstMatrixBase< T, BaseClass1 > &l, const ConstMatrixBase< T, BaseClass2 > &r) |
template<class T > | |
SparseMatrix< T > | operator+ (const Matrix< T > &L, const SparseMatrix< T > &R) |
Position | operator+ (const Position &left, const Position &right) noexcept |
template<class T > | |
SparseMatrix< T > | operator+ (const SparseMatrix< T > &L, const Matrix< T > &R) |
Matrix addition: SparseMatrix = SparseMatrix + Matrix : copy, += M. More... | |
template<class T > | |
SparseMatrix< T > | operator+ (const SparseMatrix< T > &L, const SparseMatrix< T > &R) |
Matrix addition: SparseMatrix = SparseMatrix + SparseMatrix : copy, += SM. More... | |
template<class T > | |
SparseVector< T > | operator+ (const SparseVector< T > &L, const SparseVector< T > &R) |
template<class T > | |
SparseVector< T > | operator+ (const SparseVector< T > &L, const Vector< T > &R) |
SRI | operator+ (const SRI &Sleft, const SRI &Sright) |
template<class T , class BaseClass > | |
Matrix< T > | operator+ (const T d, const ConstMatrixBase< T, BaseClass > &m) |
Adds all the elements of m by d. More... | |
template<class T > | |
SparseVector< T > | operator+ (const Vector< T > &L, const SparseVector< T > &R) |
FileSpec::FileSpecType & | operator++ (FileSpec::FileSpecType &fst, int) |
Operator++ for FileSpecType. More... | |
template<class T , class BaseClass > | |
Matrix< T > | operator- (const ConstMatrixBase< T, BaseClass > &m, const T d) |
Subtracts all the elements of m by d. More... | |
template<class T , class BaseClass1 , class BaseClass2 > | |
Matrix< T > | operator- (const ConstMatrixBase< T, BaseClass1 > &l, const ConstMatrixBase< T, BaseClass2 > &r) |
template<class T > | |
SparseMatrix< T > | operator- (const Matrix< T > &L, const SparseMatrix< T > &R) |
Matrix subtraction: SparseMatrix = Matrix - SparseMatrix. More... | |
Position | operator- (const Position &left, const Position &right) noexcept |
template<class T > | |
SparseMatrix< T > | operator- (const SparseMatrix< T > &L, const Matrix< T > &R) |
Matrix subtraction: SparseMatrix = SparseMatrix - Matrix. More... | |
template<class T > | |
SparseMatrix< T > | operator- (const SparseMatrix< T > &L, const SparseMatrix< T > &R) |
Matrix subtraction: SparseMatrix = SparseMatrix - SparseMatrix. More... | |
template<class T > | |
SparseVector< T > | operator- (const SparseVector< T > &L, const SparseVector< T > &R) |
template<class T > | |
SparseVector< T > | operator- (const SparseVector< T > &L, const Vector< T > &R) |
template<class T , class BaseClass > | |
Matrix< T > | operator- (const T d, const ConstMatrixBase< T, BaseClass > &m) |
Subtracts all the elements of m by d. More... | |
template<class T > | |
SparseVector< T > | operator- (const Vector< T > &L, const SparseVector< T > &R) |
FileSpec::FileSpecType & | operator-- (FileSpec::FileSpecType &fst, int) |
Operator– for FileSpecType. More... | |
template<class T , class BaseClass > | |
Matrix< T > | operator/ (const ConstMatrixBase< T, BaseClass > &m, const T d) |
Divides all the elements of m by d. More... | |
template<class T , class BaseClass > | |
Matrix< T > | operator/ (const T d, const ConstMatrixBase< T, BaseClass > &m) |
Divides all the elements of m by d. More... | |
bool | operator< (const IonexData::IonexValType &x, const IonexData::IonexValType &y) |
operator < for IonexData::IonexValType More... | |
bool | operator< (const RinexObsType &x, const RinexObsType &y) |
operator < for RinexObsType More... | |
std::ostream & | operator<< (FFStream &o, const FFData &f) |
ostream & | operator<< (ostream &os, const EarthOrientation &eo) |
ostream & | operator<< (ostream &os, const EOPPrediction &eopp) |
ostream & | operator<< (ostream &os, const format &f) |
ostream & | operator<< (ostream &os, const LabeledVector &LV) |
ostream & | operator<< (ostream &os, const Namelist &N) |
ostream & | operator<< (ostream &os, const SRI &S) |
ostream & | operator<< (ostream &os, const SRIleastSquares &srif) |
ostream & | operator<< (ostream &os, const TimeSystem ts) |
ostream & | operator<< (ostream &os, const WtdAveStats &was) |
ostream & | operator<< (ostream &s, CarrierBand cb) |
ostream & | operator<< (ostream &s, const BrcClockCorrection &eph) |
ostream & | operator<< (ostream &s, const BrcKeplerOrbit &eph) |
ostream & | operator<< (ostream &s, const EngEphemeris &eph) |
ostream & | operator<< (ostream &s, const Epoch &e) |
ostream & | operator<< (ostream &s, const Exception &e) |
ostream & | operator<< (ostream &s, const ExceptionLocation &e) |
ostream & | operator<< (ostream &s, const gnsstk::SatelliteSystem sys) |
ostream & | operator<< (ostream &s, const PackedNavBits &pnb) |
ostream & | operator<< (ostream &s, const Position &p) |
ostream & | operator<< (ostream &s, GLOCOrbitType e) |
ostream & | operator<< (ostream &s, GLOCRegime e) |
ostream & | operator<< (ostream &s, GLOCSatType e) |
ostream & | operator<< (ostream &s, GLOFNavPCode e) |
ostream & | operator<< (ostream &s, GLOFNavSatType e) |
ostream & | operator<< (ostream &s, GPSLNavL2Codes e) |
ostream & | operator<< (ostream &s, ObservationType ot) |
ostream & | operator<< (ostream &s, SVHealth h) |
ostream & | operator<< (ostream &s, TrackingCode tc) |
std::ostream & | operator<< (std::ostream &o, const CommonTime &ct) |
std::ostream & | operator<< (std::ostream &os, const gnsstk::Xvt &xvt) noexcept |
std::ostream & | operator<< (std::ostream &os, const LabeledMatrix &lm) |
output ostream operator for LabeledMatrix More... | |
std::ostream & | operator<< (std::ostream &os, const LabeledVector &lv) |
output ostream operator for LabeledVector More... | |
template<class T > | |
std::ostream & | operator<< (std::ostream &os, const SparseMatrix< T > &SM) |
stream output operator More... | |
template<class T > | |
std::ostream & | operator<< (std::ostream &os, const SparseVector< T > &SV) |
std::ostream & | operator<< (std::ostream &os, const TimeSystem ts) |
std::ostream & | operator<< (std::ostream &os, const Xvt::HealthStatus &health) noexcept |
std::ostream & | operator<< (std::ostream &os, IERSConvention cv) |
std::ostream & | operator<< (std::ostream &os, ReferenceFrame f) |
std::ostream & | operator<< (std::ostream &os, SatPass &sp) |
std::ostream & | operator<< (std::ostream &s, CarrierBand e) |
std::ostream & | operator<< (std::ostream &s, const AllanDeviation &a) |
std::ostream & | operator<< (std::ostream &s, const AlmOrbit &ao) |
std::ostream & | operator<< (std::ostream &s, const Angle &a) |
std::ostream & | operator<< (std::ostream &s, const AngleReduced &a) |
template<class T > | |
std::ostream & | operator<< (std::ostream &s, const BivarStats< T > &BVS) |
Output operator for BivarStats class. More... | |
std::ostream & | operator<< (std::ostream &s, const CNavFilterData &nfd) |
template<class T , class E > | |
std::ostream & | operator<< (std::ostream &s, const ConstMatrixBase< T, E > &a) |
Output operator for ConstMatrixBase classes. More... | |
template<class T , class E > | |
std::ostream & | operator<< (std::ostream &s, const ConstVectorBase< T, E > &a) |
std::ostream & | operator<< (std::ostream &s, const EngAlmanac &alm) |
std::ostream & | operator<< (std::ostream &s, const Epoch &t) |
std::ostream & | operator<< (std::ostream &s, const FormattedDouble &d) |
Stream output for FormattedDouble. More... | |
std::ostream & | operator<< (std::ostream &s, const gnsstk::GPSZcount &z) |
std::ostream & | operator<< (std::ostream &s, const gnsstk::NavMessageTypeSet &nmts) |
std::ostream & | operator<< (std::ostream &s, const gnsstk::Triple &v) |
std::ostream & | operator<< (std::ostream &s, const gnsstk::WxObservation &obs) noexcept |
std::ostream & | operator<< (std::ostream &s, const GSatID &sat) |
stream output for GSatID More... | |
std::ostream & | operator<< (std::ostream &s, const IonexData::IonexValType ivt) |
operator << for IonexData::IonexValType More... | |
std::ostream & | operator<< (std::ostream &s, const LNavFilterData &nfd) |
std::ostream & | operator<< (std::ostream &s, const NavFilterKey &nfk) |
std::ostream & | operator<< (std::ostream &s, const NavID &p) |
stream output for NavID More... | |
std::ostream & | operator<< (std::ostream &s, const NavMessageID &nmid) |
std::ostream & | operator<< (std::ostream &s, const NavSatelliteID &nsid) |
std::ostream & | operator<< (std::ostream &s, const NavSignalID &nsid) |
std::ostream & | operator<< (std::ostream &s, const ObsEpoch &oe) noexcept |
std::ostream & | operator<< (std::ostream &s, const ObsID &p) |
stream output for ObsID More... | |
std::ostream & | operator<< (std::ostream &s, const ObsRngDev &ord) noexcept |
std::ostream & | operator<< (std::ostream &s, const PackedNavBits &pnb) |
std::ostream & | operator<< (std::ostream &s, const RefFrame &rf) |
std::ostream & | operator<< (std::ostream &s, const Rinex3ObsHeader::Fields &v) |
std::ostream & | operator<< (std::ostream &s, const RinexObsType rot) |
operator << for RinexObsType More... | |
std::ostream & | operator<< (std::ostream &s, const RinexSatID &sat) |
Stream output for RinexSatID. More... | |
std::ostream & | operator<< (std::ostream &s, const SatelliteSystem sys) |
std::ostream & | operator<< (std::ostream &s, const SatID &p) |
stream output for SatID More... | |
std::ostream & | operator<< (std::ostream &s, const SatMetaData &smd) |
std::ostream & | operator<< (std::ostream &s, const SatMetaDataStore::SVNID &svn) |
std::ostream & | operator<< (std::ostream &s, const SatMetaDataStore::SystemBlock &sblk) |
template<class T > | |
std::ostream & | operator<< (std::ostream &s, const SeqStats< T > &ST) |
Output operator for SeqStats class. More... | |
std::ostream & | operator<< (std::ostream &s, const SP3SatID &sat) |
stream output for SP3SatID More... | |
template<class T > | |
std::ostream & | operator<< (std::ostream &s, const Stats< T > &ST) |
Output operator for Stats class. More... | |
std::ostream & | operator<< (std::ostream &s, const SvObsEpoch &obs) noexcept |
std::ostream & | operator<< (std::ostream &s, const Transformer &t) |
template<class T > | |
std::ostream & | operator<< (std::ostream &s, const TwoSampleStats< T > &TSS) |
Output operator for TwoSampleStats class. More... | |
template<class T > | |
std::ostream & | operator<< (std::ostream &s, const ValidType< T > &r) noexcept |
template<class T > | |
std::ostream & | operator<< (std::ostream &s, const WtdStats< T > &ST) |
Output operator for WtdStats class. More... | |
std::ostream & | operator<< (std::ostream &s, CorrectorType t) |
std::ostream & | operator<< (std::ostream &s, GLOFNavPCode e) |
std::ostream & | operator<< (std::ostream &s, GLOFNavSatType e) |
std::ostream & | operator<< (std::ostream &s, gnsstk::AngleType e) |
std::ostream & | operator<< (std::ostream &s, gnsstk::CorrDupHandling e) |
std::ostream & | operator<< (std::ostream &s, gnsstk::GalDataValid e) |
std::ostream & | operator<< (std::ostream &s, gnsstk::GalHealthStatus e) |
std::ostream & | operator<< (std::ostream &s, gnsstk::GLOCOrbitType e) |
std::ostream & | operator<< (std::ostream &s, gnsstk::GLOCRegime e) |
std::ostream & | operator<< (std::ostream &s, gnsstk::GLOCSatType e) |
std::ostream & | operator<< (std::ostream &s, gnsstk::GPSLNavL2Codes e) |
std::ostream & | operator<< (std::ostream &s, gnsstk::IonexStoreStrategy e) |
std::ostream & | operator<< (std::ostream &s, gnsstk::NavMessageType e) |
std::ostream & | operator<< (std::ostream &s, gnsstk::NavType e) |
std::ostream & | operator<< (std::ostream &s, gnsstk::NavValidityType e) |
std::ostream & | operator<< (std::ostream &s, gnsstk::ObservationType e) |
std::ostream & | operator<< (std::ostream &s, gnsstk::RefFrameRlz e) |
std::ostream & | operator<< (std::ostream &s, gnsstk::RefFrameSys e) |
std::ostream & | operator<< (std::ostream &s, gnsstk::SVHealth e) |
std::ostream & | operator<< (std::ostream &s, gnsstk::TrackingCode e) |
std::ostream & | operator<< (std::ostream &s, SatMetaData::ClockType ct) |
std::ostream & | operator<< (std::ostream &s, SatMetaData::Status status) |
std::ostream & | operator<< (std::ostream &s, XmitAnt e) |
bool | operator== (const IonexData::IonexValType &x, const IonexData::IonexValType &y) |
operator == for IonexData::IonexValType More... | |
bool | operator== (const Namelist &N1, const Namelist &N2) |
bool | operator== (const RinexObsType &x, const RinexObsType &y) |
operator == for RinexObsType More... | |
std::istream & | operator>> (FFStream &i, FFData &f) |
std::istream & | operator>> (std::istream &s, FormattedDouble &d) |
Namelist | operator^ (const Namelist &N1, const Namelist &N2) |
Namelist | operator| (const Namelist &N1, const Namelist &N2) |
template<class T , class BaseClass1 , class BaseClass2 > | |
Matrix< T > | operator|| (const ConstMatrixBase< T, BaseClass1 > &l, const ConstMatrixBase< T, BaseClass2 > &r) |
template<class T , class BaseClass1 , class BaseClass2 > | |
Matrix< T > | operator|| (const ConstMatrixBase< T, BaseClass1 > &l, const ConstVectorBase< T, BaseClass2 > &r) |
template<class T , class BaseClass1 , class BaseClass2 > | |
Matrix< T > | operator|| (const ConstVectorBase< T, BaseClass1 > &l, const ConstMatrixBase< T, BaseClass2 > &r) |
template<class T , class BaseClass1 , class BaseClass2 > | |
Matrix< T > | operator|| (const ConstVectorBase< T, BaseClass1 > &l, const ConstVectorBase< T, BaseClass2 > &r) |
template<class T > | |
SparseMatrix< T > | operator|| (const SparseMatrix< T > &L, const SparseMatrix< T > &R) |
template<class T > | |
SparseMatrix< T > | operator|| (const SparseMatrix< T > &L, const Vector< T > &V) |
Concatenation SparseMatrix || Vector TD the rest of them... More... | |
Matrix< double > | orbitNormalAttitude (const Position &pos, const Position &vel) |
template<class T , class BaseClass > | |
Matrix< T > | outer (const ConstVectorBase< T, BaseClass > &v, const ConstVectorBase< T, BaseClass > &w) |
template<class TimeTagType > | |
std::string | printAs (const CommonTime &t, const std::string &fmt) |
std::string | printTime (const CommonTime &t, const std::string &fmt) |
template<typename T > | |
void | QSort (T *sa, int na, int(*comp)(const T &, const T &)=gnsstk::Qsort_compare) |
template<typename T , typename S > | |
void | QSort (T *sa, S *pa, int na, int(*comp)(const T &, const T &)=gnsstk::Qsort_compare) |
template<typename T > | |
int | Qsort_compare (const T &a, const T &b) |
double | Rand (long seed=0) |
Generate random numbers uniformly distributed from 0 to 1. More... | |
double | RandExpCor (double dt, double sigma, double T, double xlast) |
double | RandNorm (double sigma) |
double | RandomWalk (double dt, double sigma, double xlast) |
double | range (const Position &A, const Position &B) |
void | reallyGetRecordVer2 (Rinex3ObsStream &strm, Rinex3ObsData &rod) |
void | reallyPutRecordVer2 (Rinex3ObsStream &strm, const Rinex3ObsData &rod) |
int | RegisterARLUTExtendedTypes (void) |
int | RegisterExtendedRinexObsType (std::string t, std::string d=std::string("(undefined)"), std::string u=std::string("undefined"), unsigned int dep=0) |
Function to allow user to define a new RINEX observation type. More... | |
int | RegisterExtendedRinexObsType (string t, string d, string u, unsigned int dep) |
double | RelativityCorrection (const Xvt &svPosVel) |
void | removeMilliseconds (std::vector< SatPass > &SPList, msecHandler &msh) |
void | removeMilliseconds (vector< SatPass > &SPList, msecHandler &msh) |
template<class T , class BaseClass > | |
T | RMS (const ConstVectorBase< T, BaseClass > &l) |
template<class T > | |
Matrix< T > | rotation (T angle, int axis) |
double | Round (double x) |
template<class T , class BaseClass > | |
T | RSS (const ConstVectorBase< T, BaseClass > &l) |
template<class T > | |
T | RSS (T aa, T bb) |
Perform the root sum square of aa, bb. More... | |
template<class T > | |
T | RSS (T aa, T bb, T cc) |
Perform the root sum square of aa, bb and cc. More... | |
template<class T > | |
T | RSS (T aa, T bb, T cc, T dd) |
Perform the root sum square of aa, bb, cc and dd. More... | |
Matrix< double > | satelliteAttitude (const Position &sat, const Position &sun) |
double | satelliteEarthSunAngle (const Position &sat, const Position &sun) |
void | satelliteNadirAzimuthAngles (const Position &sv, const Position &rx, const Matrix< double > &rot, double &nadir, double &azimuth) |
double | satelliteYawAngle (const Position &pos, const Position &vel, const Position &sun, const bool &blkIIRF, double &yawrate) |
int | SatPassFromRinexFiles (std::vector< std::string > &filenames, std::vector< std::string > &obstypes, double dt, std::vector< SatPass > &SPList, std::vector< RinexSatID > exSats=std::vector< RinexSatID >(), bool lenient=true, gnsstk::Epoch beginTime=gnsstk::CommonTime::BEGINNING_OF_TIME, gnsstk::Epoch endTime=gnsstk::CommonTime::END_OF_TIME) |
int | SatPassFromRinexFiles (vector< string > &filenames, vector< string > &obstypes, double dtin, vector< SatPass > &SPList, vector< RinexSatID > exSats, bool lenient, Epoch beginTime, Epoch endTime) |
int | SatPassToRinex2File (const std::string &filename, RinexObsHeader &header, std::vector< SatPass > &SPList) |
int | SatPassToRinex2File (const string &filename, RinexObsHeader &header, vector< SatPass > &SPList) |
int | SatPassToRinex3File (const std::string &filename, const Rinex3ObsHeader &header, const std::map< char, std::vector< std::string >> &sysobs, std::vector< SatPass > &SPList) |
int | SatPassToRinex3File (const string &filename, const Rinex3ObsHeader &headerIn, const map< char, vector< string >> &sysobs, vector< SatPass > &SPList) |
void | scanTime (CommonTime &t, const std::string &str, const std::string &fmt) |
void | scanTime (CommonTime &t, const string &str, const string &fmt) |
void | scanTime (TimeTag &btime, const std::string &str, const std::string &fmt) |
void | scanTime (TimeTag &btime, const string &str, const string &fmt) |
double | seriesIncompGamma (double a, double x) |
double | shadowFactor (const Position &sv, const Position &sun) |
double | shadowFactor (double angRadEarth, double angRadSun, double angSeparation) |
static void | shortcut (ostream &os, const long HOW) |
static void | shortcut (ostream &os, const long HOW) |
static void | shortcut (ostream &os, const long HOW) |
template<class T > | |
T | SimpleLagrangeInterpolation (const std::vector< T > &X, const std::vector< T > &Y, const T x) |
template<class T , class BaseClass > | |
T | slowDet (const ConstMatrixBase< T, BaseClass > &l) |
Position | solarPosition (const CommonTime &t, double &AR) |
double | solarPositionShadowFactor (double Rearth, double Rsun, double dES) |
std::string | sortRinex3ObsFiles (std::vector< std::string > &files) |
string | sortRinex3ObsFiles (vector< string > &files) |
std::string | sortRinexObsFiles (std::vector< std::string > &files) |
string | sortRinexObsFiles (vector< string > &files) |
template<class T > | |
SparseMatrix< T > | SparseHouseholder (const SparseMatrix< T > &A) |
Householder transformation of a matrix. More... | |
template<class T > | |
void | SrifMU (Matrix< T > &R, Vector< T > &Z, const Matrix< T > &H, Vector< T > &D, unsigned int M=0) |
template<class T > | |
void | SrifMU (Matrix< T > &R, Vector< T > &Z, Matrix< T > &A, unsigned int M=0) |
template<class T > | |
void | SrifMU (Matrix< T > &R, Vector< T > &Z, SparseMatrix< T > &A, const unsigned int M) |
template<class T > | |
void | SrifMU (Matrix< T > &R, Vector< T > &Z, SparseMatrix< T > &P, Vector< T > &D, const unsigned int M) |
template<class bt > | |
ListStats< bt > | stats (const std::list< bt > &lst) |
double | StudentsCDF (double t, int n) |
double | StudentsPDF (double X, int n) |
template<class T , class BaseClass > | |
T | sum (const ConstVectorBase< T, BaseClass > &l) |
void | sunOrbitAngles (const Position &pos, const Position &vel, const Position &sun, double &beta, double &phi) |
long | timeAdjust8BitWeekRollover (long toCorrectWeek, long &refWeek) |
long | timeAdjustWeekRollover (long toCorrectWeek, long &refWeek) |
static void | timeDisplay (ostream &os, const CommonTime &t) |
static void | timeDisplay (ostream &os, const CommonTime &t) |
static void | timeDisplay (ostream &os, const CommonTime &t) |
gnsstk::Xvt::HealthStatus | toXvtHealth (SVHealth e) |
Cast SVHealth to Xvt::HealthStatus. More... | |
template<class T , class BaseClass > | |
T | trace (const ConstMatrixBase< T, BaseClass > &m) |
template<class T > | |
SparseMatrix< T > | transform (const SparseMatrix< T > &M, const SparseMatrix< T > &C) |
template<class T > | |
Vector< T > | transformDiag (const SparseMatrix< T > &P, const Matrix< T > &C) |
Compute diagonal of P*C*P^T, ie diagonal of transform of square Matrix C. More... | |
template<class T , class BaseClass > | |
Matrix< T > | transpose (const ConstMatrixBase< T, BaseClass > &m) |
template<class T > | |
SparseMatrix< T > | transpose (const SparseMatrix< T > &M) |
transpose More... | |
template<class T > | |
SparseMatrix< T > | transposeTimesMatrix (const SparseMatrix< T > &M) |
template<typename T > | |
std::string | typeString () |
template<class T > | |
Matrix< T > | UDU (const Matrix< T > &A, Vector< T > &D) |
Matrix< double > | upEastNorth (Position &pos, bool geocentric) |
Matrix< double > | upEastNorthGeocentric (Position &pos) |
Matrix< double > | upEastNorthGeodetic (Position &pos) |
Same as upEastNorth, but using geodetic coordinates. More... | |
template<class T > | |
Matrix< T > | upperCholesky (const Matrix< T > &A, const T ztol=T(1.e-16)) |
template<class T > | |
SparseMatrix< T > | upperCholesky (const SparseMatrix< T > &A) |
double | ura2accuracy (short ura) noexcept |
double | ura2CNAVaccuracy (short ura) |
double | ura2CNAVNominalaccuracy (short ura) |
double | ura2nominalAccuracy (short ura) noexcept |
template<class T > | |
Matrix< T > | UTtimesTranspose (const Matrix< T > &UT) |
template<class T > | |
std::vector< T > | vec_intersect (const std::vector< T > &v1, const std::vector< T > &v2) |
template<class T > | |
std::vector< T > | vec_notintersect (const std::vector< T > &v1, const std::vector< T > &v2) |
VecBaseNewBinaryOperator Vector Vector< T > Vector< T > VecBaseNewBinaryOperator Vector VecBaseNewBinaryOperator Vector Vector< bool > Vector< bool > | VecBaseNewBinaryOperator (!=, Vector< bool >) VecBaseNewBinaryOperator(< |
VecBaseNewBinaryOperator Vector Vector< T > | VecBaseNewBinaryOperator (+, Vector< T >) VecBaseNewBinaryOperator(- |
VecBaseNewBinaryOperator Vector | VecBaseNewBinaryOperator (/, Vector< T >) VecBaseNewBinaryOperator(% |
VecBaseNewBinaryOperator Vector Vector< T > Vector< T > VecBaseNewBinaryOperator Vector VecBaseNewBinaryOperator Vector Vector< bool > | VecBaseNewBinaryOperator (<, Vector< bool >) VecBaseNewBinaryOperator(> |
VecBaseNewBinaryOperator Vector Vector< T > Vector< T > VecBaseNewBinaryOperator Vector VecBaseNewBinaryOperator Vector Vector< bool > Vector< bool > Vector< bool > | VecBaseNewBinaryOperator (>=, Vector< bool >) template< class T |
VecBaseNewBinaryOperator Vector Vector< T > Vector< T > VecBaseNewBinaryOperator Vector VecBaseNewBinaryOperator Vector | VecBaseNewBinaryOperator (|, Vector< T >) VecBaseNewBinaryOperator( |
VecShortwireComparisonOperator (eq,==) VecShortwireComparisonOperator(ne | |
template<class T > | |
int | vectorindex (const std::vector< T > &vec, const T &value) |
template<class TimeTagType > | |
bool | willPrintAs (const std::string &fmt) |
Variables | |
const GNSSTK_EXPORT NavMessageTypeSet | allNavMessageTypes |
const double | BDS_EPOCH_JD = 2453736.5 |
'Julian day' of BDS epoch (Jan. 1, 2006). More... | |
const long | BDS_EPOCH_MJD = 53736L |
Modified Julian Date of BDS epoch (Jan. 1, 2006). More... | |
const long | BDS_WEEK_PER_EPOCH = 8192L |
Weeks per BDS Epoch. More... | |
const Epoch | BEGINNING_OF_TIME (CommonTime::BEGINNING_OF_TIME) |
Earliest representable Epoch. More... | |
static const double | C2_FACT = 40.3e+16 |
static const std::ios_base::iostate | crcbit = std::ios_base::iostate(0x01) |
Define additional/other bits are the data requires. More... | |
const double | DAY_PER_MS = 1.0/MS_PER_DAY |
Days per milliseconds. More... | |
const double | DAY_PER_SEC = 1.0/SEC_PER_DAY |
Days per second. More... | |
const double | DAY_PER_ZCOUNT = 1.0/ZCOUNT_PER_DAY |
Days in a Zcount. More... | |
CommandOptionVec | defaultCommandOptionList |
const Epoch | END_OF_TIME (CommonTime::END_OF_TIME) |
Latest Representable Epoch. More... | |
static const std::ios_base::iostate | fmtbit = std::ios_base::iostate(0x02) |
const double | FREQ_BEIDOU_B1 = 1561.098e6 |
BeiDou B1 carrier frequency in Hz. More... | |
const double | FREQ_BEIDOU_B1U = 1589.742e6 |
BeiDou B1U carrier frequency in Hz. More... | |
const double | FREQ_BEIDOU_B2 = 1191.795e6 |
BeiDou B2 carrier frequency in Hz. More... | |
const double | FREQ_BEIDOU_B2a = 1176.45e6 |
BeiDou B2a carrier frequency in Hz. More... | |
const double | FREQ_BEIDOU_B2b = 1207.14e6 |
BeiDou B2b carrier frequency in Hz. More... | |
const double | FREQ_BEIDOU_B3 = 1268.52e6 |
BeiDou B3 carrier frequency in Hz. More... | |
const double | FREQ_BEIDOU_L1 = 1575.42e6 |
BeiDou L1 carrier frequency in Hz. More... | |
const double | FREQ_GALILEO_E1 = 1575.42e6 |
Galileo E1 carrier frequency in Hz. More... | |
const double | FREQ_GALILEO_E5 = 1191.795e6 |
Galileo E5 carrier frequency in Hz. More... | |
const double | FREQ_GALILEO_E5a = 1176.45e6 |
Galileo E5a carrier frequency in Hz. More... | |
const double | FREQ_GALILEO_E5b = 1207.14e6 |
Galileo E5b carrier frequency in Hz. More... | |
const double | FREQ_GALILEO_E6 = 1278.75e6 |
Galileo E6 carrier frequency in Hz. More... | |
const double | FREQ_GLONASS_G1 = 1602e6 |
GLONASS G1 carrier frequency in Hz. More... | |
const double | FREQ_GLONASS_G1a = 1600.995e6 |
GLONASS G1a carrier frequency in Hz. More... | |
const double | FREQ_GLONASS_G2 = 1246e6 |
GLONASS G2 carrier frequency in Hz. More... | |
const double | FREQ_GLONASS_G2a = 1248.06e6 |
GLONASS G2a carrier frequency in Hz. More... | |
const double | FREQ_GLONASS_G2c = 1242e6 |
GLONASS G2c carrier frequency in Hz. More... | |
const double | FREQ_GLONASS_G3 = 1202.025e6 |
GLONASS G3 carrier frequency in Hz. More... | |
const double | FREQ_GLONASS_G5 = 1207.14e6 |
GLONASS G5 carrier frequency in Hz. More... | |
const double | FREQ_GPS_L1 = 1575.42e6 |
GPS L1 carrier frequency in Hz. More... | |
const double | FREQ_GPS_L2 = 1227.6e6 |
GPS L2 carrier frequency in Hz. More... | |
const double | FREQ_GPS_L5 = 1176.45e6 |
GPS L5 carrier frequency in Hz. More... | |
const double | FREQ_NAVIC_L5 = 1176.45e6 |
NavIC L5 carrier frequency in Hz. More... | |
const double | FREQ_NAVIC_S = 2492.028e6 |
NavIC S carrier frequency in Hz. More... | |
const double | FREQ_QZSS_L1 = 1575.42e6 |
QZSS L1 carrier frequency in Hz. More... | |
const double | FREQ_QZSS_L2 = 1227.6e6 |
QZSS L2 carrier frequency in Hz. More... | |
const double | FREQ_QZSS_L5 = 1176.45e6 |
QZSS L5 carrier frequency in Hz. More... | |
const double | FREQ_QZSS_L6 = 1278.75e6 |
QZSS L6 carrier frequency in Hz. More... | |
const double | FREQ_SBAS_L1 = 1575.42e6 |
SBAS L1 carrier frequency in Hz. More... | |
const double | FREQ_SBAS_L5 = 1176.45e6 |
SBAS L5 carrier frequency in Hz. More... | |
const double | FREQ_STEP_GLONASS_G1 = 562.5e3 |
GLONASS G1 carrier frequency step size in Hz. More... | |
const double | FREQ_STEP_GLONASS_G2 = 437.5e3 |
GLONASS G2 carrier frequency step size in Hz. More... | |
const long | FULLWEEK = 604800L |
Seconds per whole week. More... | |
const double | GAL_EPOCH_JD = 2451412.5 |
'Julian day' of GAL epoch (Aug 22 1999) More... | |
const long | GAL_EPOCH_MJD = 51412L |
Modified Julian Date of GAL epoch (Aug 22 1999) More... | |
const long | GAL_WEEK_PER_EPOCH = 4096L |
Weeks per GAL Epoch. More... | |
static const double | GGdryscale = 8594.777388436570600 |
static const double | GGwetscale = 2540.042008403690900 |
const double | GLO_EPOCH_JD = 2450082.5 |
'Julian day' of GLONASS epoch (Jan. 1, 1996). More... | |
const long | GLO_EPOCH_MJD = 50083 |
Modified Julian Date of GLONASS epoch (Jan. 1, 1996). More... | |
static GNSSTKFormatInitializer | gnsstkMFNDFI |
const double | GPS_EPOCH_JD = 2444244.5 |
'Julian day' of GPS epoch (Jan. 6, 1980). More... | |
const long | GPS_EPOCH_MJD = 44244L |
Modified Julian Date of GPS epoch (Jan. 6, 1980). More... | |
const long | GPS_WEEK_PER_EPOCH = 1024L |
Weeks per GPS Epoch. More... | |
const long | HALFWEEK = 302400L |
Seconds per half week. More... | |
const double | IRN_EPOCH_JD = 2451412.5 |
'Julian day' of IRN epoch (Aug 22, 1999). More... | |
const long | IRN_EPOCH_MJD = 51412L |
Modified Julian Date of BDS epoch (Aug 22, 1999). More... | |
const long | IRN_WEEK_PER_EPOCH = 1024L |
Weeks per BDS Epoch. More... | |
const double | L1_FREQ_BDS = 1561.098e6 |
BDS L1 (B1) carrier frequency in Hz. More... | |
const double | L1_FREQ_GAL = L1_FREQ_GPS |
GAL L1 (E1) carrier frequency in Hz. More... | |
const double | L1_FREQ_GEO = L1_FREQ_GPS |
GEO L1 carrier frequency in Hz. More... | |
const double | L1_FREQ_GLO = 1602.0e6 |
GLO L1 carrier base frequency in Hz. More... | |
const double | L1_FREQ_GPS = 1575.42e6 |
GPS L1 carrier frequency in Hz. More... | |
const double | L1_FREQ_QZS = L1_FREQ_GPS |
QZS L1 carrier frequency in Hz. More... | |
const double | L1_FREQ_STEP_GLO = 562.5e3 |
GLO L1 carrier frequency step size in Hz. More... | |
const double | L1_WAVELENGTH_BDS = 0.192039486310276 |
BDS L1 carrier wavelength in meters. More... | |
const double | L1_WAVELENGTH_GAL = L1_WAVELENGTH_GPS |
GAL L1 carrier wavelength in meters. More... | |
const double | L1_WAVELENGTH_GEO = L1_WAVELENGTH_GPS |
GEO L1 carrier wavelength in meters. More... | |
const double | L1_WAVELENGTH_GLO = 0.187136365793 |
GLO L1 carrier wavelength in meters. More... | |
const double | L1_WAVELENGTH_GPS = 0.190293672798 |
GPS L1 carrier wavelength in meters. More... | |
const double | L1_WAVELENGTH_QZS = L1_WAVELENGTH_GPS |
QZS L1 carrier wavelength in meters. More... | |
const double | L2_FREQ_BDS = L7_FREQ_GAL |
BDS L2 (B2) carrier frequency in Hz. More... | |
const double | L2_FREQ_GLO = 1246.0e6 |
GLO L2 carrier base frequency in Hz. More... | |
const double | L2_FREQ_GPS = 1227.60e6 |
GPS L2 carrier frequency in Hz. More... | |
const double | L2_FREQ_QZS = L2_FREQ_GPS |
QZS L2 carrier frequency in Hz. More... | |
const double | L2_FREQ_STEP_GLO = 437.5e3 |
GLO L2 carrier frequency step size in Hz. More... | |
const double | L2_WAVELENGTH_BDS = L7_WAVELENGTH_GAL |
BDS L2 carrier wavelength in meters. More... | |
const double | L2_WAVELENGTH_GLO = 0.240603898876 |
GLO L2 carrier wavelength in meters. More... | |
const double | L2_WAVELENGTH_GPS = 0.244210213425 |
GPS L2 carrier wavelength in meters. More... | |
const double | L2_WAVELENGTH_QZS = L2_WAVELENGTH_GPS |
QZS L2 carrier wavelength in meters. More... | |
const double | L3_FREQ_BDS = 1268.52e6 |
BDS L3 (B3) carrier frequency in Hz. More... | |
const double | L3_FREQ_GLO = 1202.025e6 |
GLO L3 carrier frequency in Hz. More... | |
const double | L3_WAVELENGTH_BDS = 0.236332464604421 |
BDS L3 carrier wavelength in meters. More... | |
const double | L3_WAVELENGTH_GLO = 0.249406175412 |
GLO L3 carrier wavelength in meters. More... | |
const double | L5_FREQ_GAL = L5_FREQ_GPS |
GAL L5 (E5a) carrier frequency in Hz. More... | |
const double | L5_FREQ_GEO = L5_FREQ_GPS |
GEO L5 carrier frequency in Hz. More... | |
const double | L5_FREQ_GPS = 1176.45e6 |
GPS L5 carrier frequency in Hz. More... | |
const double | L5_FREQ_QZS = L5_FREQ_GPS |
QZS L5 carrier frequency in Hz. More... | |
const double | L5_WAVELENGTH_GAL = L5_WAVELENGTH_GPS |
GAL L5 carrier wavelength in meters. More... | |
const double | L5_WAVELENGTH_GEO = L5_WAVELENGTH_GPS |
GEO L5 carrier wavelength in meters. More... | |
const double | L5_WAVELENGTH_GPS = 0.254828049 |
GPS L5 carrier wavelength in meters. More... | |
const double | L5_WAVELENGTH_QZS = L5_WAVELENGTH_GPS |
QZS L5 carrier wavelength in meters. More... | |
const double | L6_FREQ_GAL = 1278.75e6 |
GAL L6 (E6) carrier frequency in Hz. More... | |
const double | L6_FREQ_QZS = L6_FREQ_GAL |
QZS LEX(6) carrier frequency in Hz. More... | |
const double | L6_WAVELENGTH_GAL = 0.234441805 |
GAL L6 carrier wavelength in meters. More... | |
const double | L6_WAVELENGTH_QZS = L6_WAVELENGTH_GAL |
QZS LEX(6) carrier wavelength in meters. More... | |
const double | L7_FREQ_GAL = 1207.140e6 |
GAL L7 (E5b) carrier frequency in Hz. More... | |
const double | L7_WAVELENGTH_GAL = 0.24834937 |
GAL L7 carrier wavelength in meters. More... | |
const double | L8_FREQ_GAL = 1191.795e6 |
GAL L8 (E5a+E5b) carrier frequency in Hz. More... | |
const double | L8_WAVELENGTH_GAL = 0.251547001 |
GAL L8 carrier wavelength in meters. More... | |
const long | LAST_6SEC_ZCOUNT_OF_WEEK = 403200 - 4 |
static const std::ios_base::iostate | lenbit = std::ios_base::iostate(0x04) |
const long | LENGTH_OF_EOW_OVERLAP = 34 |
static short | LIMIT [] = { 127, 511 } |
const int | MAX_BIT = 32 |
Number of bits assumed to be in a unsigned long int. More... | |
const long | MAX_PRN = 32 |
const int | MAX_PRN_CODE = 210 |
Maximum PRN Code number (1-n) More... | |
const long | MAX_PRN_GPS = 32 |
const int | MAX_WORD = 140 |
const long | MAX_X2_COUNT = X2A_EPOCH_DELAY + MAX_X2_TEST |
const long | MAX_X2_TEST = 4 * ((XA_COUNT * XA_MAX_EPOCH) + X2A_EPOCH_DELAY) |
const double | maxBias = 999999.0 |
A clock bias >= this is considered bad. More... | |
const long | MJD_JDAY = 2400001L |
'Julian day' offset from MJD More... | |
const double | MJD_TO_JD = 2400000.5 |
Add this offset to convert Modified Julian Date to Julian Date. More... | |
static const double | MOPSg =9.80665 |
static const double | MOPSgm =9.784 |
static const double | MOPSk1 =77.604 |
static const double | MOPSk2 =382000.0 |
static const double | MOPSRd =287.054 |
const long | MS_PER_DAY = MS_PER_SEC * SEC_PER_DAY |
Milliseconds in a day. More... | |
const long | MS_PER_SEC = 1000L |
Milliseconds in a second. More... | |
static const double | NBg =9.80665 |
static const double | NBk1 =77.604 |
static const double | NBk3p =382000 |
static const double | NBLat [5] ={ 15.0, 30.0, 45.0, 60.0, 75.0} |
static const double | NBMaa [5] |
static const double | NBMad [5] |
static const double | NBMaw [5] |
static const double | NBMba [5] |
static const double | NBMbd [5] |
static const double | NBMbw [5] |
static const double | NBMca [5] |
static const double | NBMcd [5] |
static const double | NBMcw [5] |
static const double | NBRd =287.054 |
static const double | NBZB0 [5] ={6.30e-3,6.05e-3,5.58e-3,5.39e-3,4.53e-3} |
static const double | NBZBa [5] ={ 0.0,0.25e-3,0.32e-3,0.81e-3,0.62e-3} |
static const double | NBZL0 [5] ={ 2.77, 3.15, 2.57, 1.81, 1.55} |
static const double | NBZLa [5] ={ 0.0, 0.33, 0.46, 0.74, 0.30} |
static const double | NBZP0 [5] ={1013.25,1017.25,1015.75,1011.75,1013.00} |
static const double | NBZPa [5] ={ 0.0, -3.75, -2.25, -1.75, -0.50} |
static const double | NBZT0 [5] ={ 299.65, 294.15, 283.15, 272.15, 263.65} |
static const double | NBZTa [5] ={ 0.0, 7.0, 11.0, 15.0, 14.5} |
static const double | NBZW0 [5] ={ 26.31, 21.79, 11.66, 6.78, 4.11} |
static const double | NBZWa [5] ={ 0.0, 8.85, 7.24, 5.36, 3.39} |
static const double | NeillDryA [5] |
static const double | NeillDryA1 [5] |
static const double | NeillDryB [5] |
static const double | NeillDryB1 [5] |
static const double | NeillDryC [5] |
static const double | NeillDryC1 [5] |
static const double | NeillWetA [5] |
static const double | NeillWetB [5] |
static const double | NeillWetC [5] |
const long | NUM_6SEC_WORDS = 1918125 |
Number of 4 byte unsigned ints necessary to hold 6 sec of P-code. More... | |
const long | NUM_X2_WORDS = 1918131 |
Number of 4 byte unsigned ints necessary to hold an X2 sequence (with leading delay) More... | |
const long | OVERLAP_WORD_POSITION = 1451897 |
static const std::ios_base::iostate | parbit = std::ios_base::iostate(0x08) |
static double | PItab [7] |
Table of powers of PI, initialized in EngNav(). More... | |
const double | QZS_EPOCH_JD = 2444244.5 |
'Julian day' of QZS epoch (Jan. 1, 1980). More... | |
const long | QZS_EPOCH_MJD = 44244L |
Modified Julian Date of QZS epoch (Jan. 1, 1980). More... | |
const long | QZS_WEEK_PER_EPOCH = 65535L |
Weeks per QZS Epoch. More... | |
static short | RANGE [] = { 256, 1024 } |
static const double | SaasDryA [5] |
static const double | SaasDryA1 [5] |
static const double | SaasDryB [5] |
static const double | SaasDryB1 [5] |
static const double | SaasDryC [5] |
static const double | SaasDryC1 [5] |
static const double | SaasWetA [5] |
static const double | SaasWetB [5] |
static const double | SaasWetC [5] |
const long | SEC_PER_DAY = 86400L |
Seconds per day. More... | |
const double | SEC_PER_MS = 1.0/MS_PER_SEC |
Seconds per millisecond. More... | |
RinexObsType | sot [29] |
const Matrix< double > | SRINullMatrix |
constant (empty) Matrix used for default input arguments More... | |
const SparseMatrix< double > | SRINullSparseMatrix |
constant (empty) SparseMatrix used for default input arguments More... | |
static std::vector< std::vector< DecodeQuant > > | subframeListFoo |
const double | SV_ACCURACY_GPS_MAX_INDEX [] |
map from SV accuracy/URA flag to maximum accuracy values in m More... | |
const int | SV_ACCURACY_GPS_MAX_INDEX_VALUE = 15 |
constant for the max array index in sv accuracy table More... | |
const double | SV_ACCURACY_GPS_MIN_INDEX [] |
map from SV accuracy/URA flag to minimum accuracy values in m More... | |
const double | SV_ACCURACY_GPS_NOMINAL_INDEX [] |
const double | SV_CNAV_ACCURACY_GPS_MAX_INDEX [] |
map from SV accuracy/URA flag to maximum accuracy values in m More... | |
const int | SV_CNAV_ACCURACY_GPS_MAX_INDEX_VALUE = 15 |
constant for the max array index in sv accuracy table More... | |
const double | SV_CNAV_ACCURACY_GPS_MIN_INDEX [] |
map from SV accuracy/URA flag to minimum accuracy values in m More... | |
const double | SV_CNAV_ACCURACY_GPS_NOM_INDEX [] |
const int | SV_CNAV_INDEX_OFFSET = 15 |
constant for gps nom index table offset More... | |
const int | SV_CNAV_NOMINAL_MAX_INDEX = 30 |
constant for max array index in gps nom index table More... | |
static const char * | SystemNames [] |
const long | UNIX_MJD = 40587L |
Modified Julian Date of UNIX epoch (Jan. 1, 1970). More... | |
const double | WAVELENGTH_BEIDOU_B1 = C_MPS / FREQ_BEIDOU_B1 |
BeiDou B1 carrier wavelength in meters. More... | |
const double | WAVELENGTH_BEIDOU_B1U = C_MPS / FREQ_BEIDOU_B1U |
BeiDou B1U carrier wavelength in meters. More... | |
const double | WAVELENGTH_BEIDOU_B2 = C_MPS / FREQ_BEIDOU_B2 |
BeiDou B2 carrier wavelength in meters. More... | |
const double | WAVELENGTH_BEIDOU_B2a = C_MPS / FREQ_BEIDOU_B2a |
BeiDou B2a carrier wavelength in meters. More... | |
const double | WAVELENGTH_BEIDOU_B2b = C_MPS / FREQ_BEIDOU_B2b |
BeiDou B2b carrier wavelength in meters. More... | |
const double | WAVELENGTH_BEIDOU_B3 = C_MPS / FREQ_BEIDOU_B3 |
BeiDou B3 carrier wavelength in meters. More... | |
const double | WAVELENGTH_BEIDOU_L1 = C_MPS / FREQ_BEIDOU_L1 |
BeiDou L1 carrier wavelength in meters. More... | |
const double | WAVELENGTH_GALILEO_E1 = C_MPS / FREQ_GALILEO_E1 |
Galileo E1 carrier wavelength in meters. More... | |
const double | WAVELENGTH_GALILEO_E5 = C_MPS / FREQ_GALILEO_E5 |
Galileo E5 carrier wavelength in meters. More... | |
const double | WAVELENGTH_GALILEO_E5a = C_MPS / FREQ_GALILEO_E5a |
Galileo E5a carrier wavelength in meters. More... | |
const double | WAVELENGTH_GALILEO_E5b = C_MPS / FREQ_GALILEO_E5b |
Galileo E5b carrier wavelength in meters. More... | |
const double | WAVELENGTH_GALILEO_E6 = C_MPS / FREQ_GALILEO_E6 |
Galileo E6 carrier wavelength in meters. More... | |
const double | WAVELENGTH_GLONASS_G1 = C_MPS / FREQ_GLONASS_G1 |
GLONASS G1 carrier wavelength in meters. More... | |
const double | WAVELENGTH_GLONASS_G1a = C_MPS / FREQ_GLONASS_G1a |
GLONASS G1a carrier wavelength in meters. More... | |
const double | WAVELENGTH_GLONASS_G2 = C_MPS / FREQ_GLONASS_G2 |
GLONASS G2 carrier wavelength in meters. More... | |
const double | WAVELENGTH_GLONASS_G2a = C_MPS / FREQ_GLONASS_G2a |
GLONASS G2a carrier wavelength in meters. More... | |
const double | WAVELENGTH_GLONASS_G2c = C_MPS / FREQ_GLONASS_G2c |
GLONASS G2c carrier wavelength in meters. More... | |
const double | WAVELENGTH_GLONASS_G3 = C_MPS / FREQ_GLONASS_G3 |
GLONASS G3 carrier wavelength in meters. More... | |
const double | WAVELENGTH_GLONASS_G5 = C_MPS / FREQ_GLONASS_G5 |
GLONASS G5 carrier wavelength in meters. More... | |
const double | WAVELENGTH_GPS_L1 = C_MPS / FREQ_GPS_L1 |
GPS L1 carrier wavelength in meters. More... | |
const double | WAVELENGTH_GPS_L2 = C_MPS / FREQ_GPS_L2 |
GPS L2 carrier wavelength in meters. More... | |
const double | WAVELENGTH_GPS_L5 = C_MPS / FREQ_GPS_L5 |
GPS L5 carrier wavelength in meters. More... | |
const double | WAVELENGTH_NAVIC_L5 = C_MPS / FREQ_NAVIC_L5 |
NavIC L5 carrier wavelength in meters. More... | |
const double | WAVELENGTH_NAVIC_S = C_MPS / FREQ_NAVIC_S |
NavIC S carrier wavelength in meters. More... | |
const double | WAVELENGTH_QZSS_L1 = C_MPS / FREQ_QZSS_L1 |
QZSS L1 carrier wavelength in meters. More... | |
const double | WAVELENGTH_QZSS_L2 = C_MPS / FREQ_QZSS_L2 |
QZSS L2 carrier wavelength in meters. More... | |
const double | WAVELENGTH_QZSS_L5 = C_MPS / FREQ_QZSS_L5 |
QZSS L5 carrier wavelength in meters. More... | |
const double | WAVELENGTH_QZSS_L6 = C_MPS / FREQ_QZSS_L6 |
QZSS L6 carrier wavelength in meters. More... | |
const double | WAVELENGTH_SBAS_L1 = C_MPS / FREQ_SBAS_L1 |
SBAS L1 carrier wavelength in meters. More... | |
const double | WAVELENGTH_SBAS_L5 = C_MPS / FREQ_SBAS_L5 |
SBAS L5 carrier wavelength in meters. More... | |
const double | WEEK_PER_ZCOUNT = 1.0/ZCOUNT_PER_WEEK |
Weeks in a Zcount. More... | |
static const char * | weekday [] |
static const char * | weekdayAbbr [] |
const int | X1_PER_DAY = 57600 |
Number of X1 epochs in one day. More... | |
const unsigned int | X1A_INIT = 0x0248 |
INIT variables are starting conditions of 12-bit registers (IS-GPS-200) More... | |
const unsigned int | X1A_TAPS = 0x0CA0 |
TAPS variables denote which stages of 12-bit registers are XOR'd. More... | |
const unsigned int | X1B_INIT = 0x0554 |
const unsigned int | X1B_TAPS = 0x0F93 |
const long | X2A_EPOCH_DELAY = 37 |
The 37 chip delay at the end of every X2A epoch. More... | |
const unsigned int | X2A_INIT = 0x0925 |
const unsigned int | X2A_TAPS = 0x0FDD |
const unsigned int | X2B_INIT = 0x0554 |
const unsigned int | X2B_TAPS = 0x098E |
const int | XA_COUNT = 4092 |
X?_COUNT is the number of bits in an epoch. More... | |
const long | XA_EPOCH_DELAY = 0 |
const int | XA_MAX_EPOCH = 3750 |
X?_MAX_EPOCH is the maximum number of epochs in a sequence. More... | |
const int | XB_COUNT = 4093 |
const long | XB_EPOCH_DELAY = 343 |
const int | XB_MAX_EPOCH = 3749 |
const long | ZCOUNT_PER_DAY = 57600L |
Zcounts in a day. More... | |
const long | ZCOUNT_PER_HOUR = 2400 |
Z-counts per hour. More... | |
const long | ZCOUNT_PER_MINUTE = 40 |
Z-counts per minute. More... | |
const long | ZCOUNT_PER_WEEK = 403200L |
Zcounts in a week. More... | |
GNSS Constants | |
Time constants are in TimeConstants.hpp | |
const double | PI = 3.141592653589793238462643383280 |
GPS value of PI; also specified by GAL. More... | |
const double | DEG2RAD = PI / 180.0 |
Multiply degrees by DEG2RAD to get radians. More... | |
const double | RAD2DEG = 180.0 / PI |
Multiply radians by RAD2DEG to get degrees. More... | |
const double | TWO_PI = 6.283185307179586476925286766559 |
GPS value of PI*2. More... | |
const double | SQRT_PI = 1.772453850905516027298167483341 |
GPS value of PI**0.5. More... | |
const double | REL_CONST = -4.442807633e-10 |
relativity constant (sec/sqrt(m)) More... | |
const double | C_MPS = 2.99792458e8 |
m/s, speed of light; this value defined by GPS but applies to GAL and GLO. More... | |
static const double | DEG_TO_RAD = 1.7453292519943e-2 |
Conversion Factor from degrees to radians (units: degrees^-1) More... | |
static const double | RAD_TO_DEG = 57.295779513082 |
Conversion Factor from radians to degrees (units: degrees) More... | |
static const double | DEG_PER_MAS = 2.77777777777e-7 |
degrees per milliarcsecond (1e-3/3600.) More... | |
static const double | RAD_PER_MAS = 4.84813681e-9 |
radians per milliarcsecond More... | |
static const double | PPB = 1.e-9 |
parts per billion More... | |
const double | OSC_FREQ_GPS = 10.23e6 |
Hz, GPS Oscillator or chip frequency. More... | |
const double | PY_CHIP_FREQ_GPS = OSC_FREQ_GPS |
Hz, GPS chip rate of the P & Y codes. More... | |
const double | CA_CHIP_FREQ_GPS = OSC_FREQ_GPS / 10.0 |
Hz, GPS chip rate of the C/A code. More... | |
const double | RSVCLK_GPS = 10.22999999543e6 |
Hz, GPS Base freq w/o relativisitic effects. More... | |
const double | L1_MULT_GPS = 154.0 |
GPS L1 frequency in units of oscillator frequency. More... | |
const double | L2_MULT_GPS = 120.0 |
GPS L2 frequency in units of oscillator frequency. More... | |
const double | L5_MULT_GPS = 115.0 |
GPS L5 frequency in units of oscillator frequency. More... | |
const double | GAMMA_GPS_12 = (L1_MULT_GPS/L2_MULT_GPS) * (L1_MULT_GPS/L2_MULT_GPS) |
GPS Gamma constants. More... | |
const double | GAMMA_GPS_15 = (L1_MULT_GPS/L5_MULT_GPS) * (L1_MULT_GPS/L5_MULT_GPS) |
const double | GAMMA_GPS = 1.646944444 |
const double | A_REF_GPS = 26559710.0 |
Reference Semi-major axis. From IS-GPS-800 Table 3.5-2 in meters. More... | |
const double | OMEGADOT_REF_GPS = -2.6e-9 * PI |
Omega reference value from Table 30-I converted to radians. More... | |
const double | OSC_FREQ_GLO = 5.11e6 |
GLO Fundamental chip rate in Hz. More... | |
const double | PY_CHIP_FREQ_GLO = OSC_FREQ_GLO |
GLO Chip rate of the P & Y codes in Hz. More... | |
const double | CA_CHIP_FREQ_GLO = OSC_FREQ_GLO / 10.0 |
GLO Chip rate of the C/A code in Hz. More... | |
const double | PSC_FREQ_GLO = 5.00e6 |
GLO Fundamental oscillator freq in Hz. More... | |
const double | RSVCLK_GLO = 4.99999999782e6 |
GLO Base freq w/o relativisitic effects in Hz. More... | |
const double | L1_MULT_GLO = 320.4 |
GLO L1 multiplier. More... | |
const double | L2_MULT_GLO = 249.2 |
GLO L2 multiplier. More... | |
const int | SV_ACCURACY_GLO_INDEX_MAX = 15 |
Constant for the max array index in SV accuracy table. More... | |
const double | SV_ACCURACY_GLO_INDEX [] |
const long | MAX_PRN_COM = 63 |
The maximum number of active satellites in the Compass constellation. More... | |
const long | MIN_GEO_BDS_II = 1 |
The first ranging code number for BeiDou GEO phase II satellites. More... | |
const long | MAX_GEO_BDS_II = 5 |
The last ranging code number for BeiDou GEO phase II satellites. More... | |
const long | MIN_MEO_BDS = 6 |
The first ranging code number for BeiDou MEO/IGSO satellites. More... | |
const long | MAX_MEO_BDS = 58 |
The last ranging code number for BeiDou MEO/IGSO satellites. More... | |
const long | MIN_GEO_BDS_III = 59 |
The first ranging code number for BeiDou GEO phase III satellites. More... | |
const long | MAX_GEO_BDS_III = 63 |
The last ranging code number for BeiDou GEO phase III satellites. More... | |
const int | MIN_PRN_QZS = 193 |
First assigned PRN in QZSS. More... | |
const int | MAX_PRN_QZS = 206 |
Last assigned PRN in QZSS (all signals) More... | |
const int | MAX_PRN_QZS_LNAV = 202 |
Last assigned PRN in QZSS (LNAV only) More... | |
short | getLegacyFitInterval (const short iodc, const short fiti) |
bool | isBeiDouGEO (const SatID &sat) |
Return true if the given SatID is BeiDou GEO (expecting D2 nav). More... | |
typedef std::map<SatID, AlmOrbit> gnsstk::AlmOrbits |
Definition at line 123 of file AlmOrbit.hpp.
Define an iterator so C++11 can do things like for (AngleType i : AngleTypeIterator())
Definition at line 67 of file AngleType.hpp.
typedef EnumIterator<CarrierBand, CarrierBand::Unknown, CarrierBand::Last> gnsstk::CarrierBandIterator |
Define an iterator so C++11 can do things like for (CarrierBand i : CarrierBandIterator())
Definition at line 80 of file CarrierBand.hpp.
typedef std::vector<CommandOption*> gnsstk::CommandOptionVec |
Definition at line 66 of file CommandOption.hpp.
typedef EnumIterator<CorrDupHandling, CorrDupHandling::Unknown, CorrDupHandling::Last> gnsstk::CorrDupHandlingIterator |
Define an iterator so C++11 can do things like for (CorrDupHandling i : CorrDupHandlingIterator())
Definition at line 71 of file CorrDupHandling.hpp.
typedef std::set<CorrDupHandling> gnsstk::CorrDupHandlingSet |
Set of message types, used by NavLibrary and NavDataFactory.
Definition at line 73 of file CorrDupHandling.hpp.
typedef std::list<CorrectionResult> gnsstk::CorrectionResultList |
Just an ordered list of group path correction results.
Definition at line 73 of file CorrectionResult.hpp.
typedef EnumIterator<CorrectorType, CorrectorType::Unknown, CorrectorType::Last> gnsstk::CorrectorTypeIterator |
Define an iterator so C++11 can do things like for (CorrectorType i : CorrectorTypeIterator())
Definition at line 65 of file CorrectorType.hpp.
typedef std::set<CorrectorType> gnsstk::CorrectorTypeSet |
Set of message types, used by NavLibrary and NavDataFactory.
Definition at line 67 of file CorrectorType.hpp.
Define an iterator so C++11 can do things like for (DumpDetail i : DumpDetailIterator())
Definition at line 63 of file DumpDetail.hpp.
typedef EnumIterator<GalDataValid, GalDataValid::Unknown, GalDataValid::Last> gnsstk::GalDataValidIterator |
Define an iterator so C++11 can do things like for (GalDataValid i : GalDataValidIterator())
Definition at line 61 of file GalDataValid.hpp.
typedef EnumIterator<GalHealthStatus, GalHealthStatus::Unknown, GalHealthStatus::Last> gnsstk::GalHealthStatusIterator |
Define an iterator so C++11 can do things like for (GalHealthStatus i : GalHealthStatusIterator())
Definition at line 63 of file GalHealthStatus.hpp.
Wrapper for the Goad and Goodman trop model with heights.
Definition at line 145 of file TropCorrector.hpp.
Wrapper for the Goad and Goodman trop model.
Definition at line 143 of file TropCorrector.hpp.
Wrapper for the global trop model (Boehm et al).
Definition at line 149 of file TropCorrector.hpp.
typedef EnumIterator<GLOFNavPCode, GLOFNavPCode::Unknown, GLOFNavPCode::Last> gnsstk::GLOFNavPCodeIterator |
Define an iterator so C++11 can do things like for (GLOFNavPCode i : GLOFNavPCodeIterator())
Definition at line 68 of file GLOFNavPCode.hpp.
typedef EnumIterator<GLOFNavSatType, GLOFNavSatType::Unknown, GLOFNavSatType::Last> gnsstk::GLOFNavSatTypeIterator |
Define an iterator so C++11 can do things like for (GLOFNavSatType i : GLOFNavSatTypeIterator())
Definition at line 61 of file GLOFNavSatType.hpp.
typedef std::set<std::shared_ptr<GPSLNavEph>,GPSLNavEphCEIComp> gnsstk::GPSLNavCEIUniq |
Store GPSLNavEph shared_ptrs using GPSLNavEphCEIComp to sort.
Definition at line 147 of file GPSLNavEph.hpp.
typedef std::set<std::shared_ptr<GPSLNavEph>, GPSLNavEphIODCComp> gnsstk::GPSLNavIODCUniq |
Store GPSLNavEph shared_ptrs using GPSLNavEphIODCComp to sort.
Definition at line 132 of file GPSLNavEph.hpp.
typedef EnumIterator<GPSLNavL2Codes, GPSLNavL2Codes::Unknown, GPSLNavL2Codes::Last> gnsstk::GPSLNavL2CodesIterator |
Define an iterator so C++11 can do things like for (GPSLNavL2Codes i : GPSLNavL2CodesIterator())
Definition at line 63 of file GPSLNavL2Codes.hpp.
typedef std::list<GroupPathCorrectorPtr> gnsstk::GroupPathCorrectorList |
Short-hand for container.
Definition at line 93 of file GroupPathCorrector.hpp.
typedef std::shared_ptr<GroupPathCorrector> gnsstk::GroupPathCorrectorPtr |
Short-hand for shared_ptr.
Definition at line 91 of file GroupPathCorrector.hpp.
typedef EnumIterator<IonexStoreStrategy, IonexStoreStrategy::Unknown, IonexStoreStrategy::Last> gnsstk::IonexStoreStrategyIterator |
Define an iterator so C++11 can do things like for (IonexStoreStrategy i : IonexStoreStrategyIterator())
Definition at line 63 of file IonexStoreStrategy.hpp.
typedef std::multimap<NavSignalID, NavDataFactoryPtr> gnsstk::NavDataFactoryMap |
Map signal to a factory.
Definition at line 400 of file NavDataFactory.hpp.
typedef std::shared_ptr<NavDataFactory> gnsstk::NavDataFactoryPtr |
Managed pointer to NavDataFactory.
Definition at line 398 of file NavDataFactory.hpp.
typedef std::shared_ptr<NavData> gnsstk::NavDataPtr |
Factories instantiate these in response to find() requests.
Definition at line 62 of file NavData.hpp.
typedef std::list<NavDataPtr> gnsstk::NavDataPtrList |
List of NavDataPtr, typically used when converting from source data to NavDataPtr when multiple objects can be created from a single input.
Definition at line 75 of file NavData.hpp.
typedef std::map<CommonTime, NavDataPtr> gnsstk::NavMap |
Map nav message transmit time to nav message.
Definition at line 67 of file NavData.hpp.
typedef std::set<NavMessageID> gnsstk::NavMessageIDSet |
Definition at line 101 of file NavMessageID.hpp.
typedef std::map<NavMessageType, NavSatMap> gnsstk::NavMessageMap |
Map nav message type to the rest of the storage.
Definition at line 71 of file NavData.hpp.
typedef EnumIterator<NavMessageType, NavMessageType::Unknown, NavMessageType::Last> gnsstk::NavMessageTypeIterator |
Define an iterator so C++11 can do things like for (NavMessageType i : NavMessageTypeIterator())
Definition at line 74 of file NavMessageType.hpp.
typedef std::set<NavMessageType> gnsstk::NavMessageTypeSet |
Set of message types, used by NavLibrary and NavDataFactory.
Definition at line 76 of file NavMessageType.hpp.
typedef std::map<CommonTime, NavDataPtrList> gnsstk::NavNearMap |
Map from "nearest" time reference (e.g. toe) to list of NavDataPtr.
Definition at line 77 of file NavData.hpp.
typedef std::map<NavMessageType, NavNearSatMap> gnsstk::NavNearMessageMap |
Map nav message type to the rest of the storage.
Definition at line 81 of file NavData.hpp.
typedef std::map<NavSatelliteID, NavNearMap> gnsstk::NavNearSatMap |
Map satellite to nearest map.
Definition at line 79 of file NavData.hpp.
typedef std::multimap<int, XRefNode>::const_iterator gnsstk::NAVNumXRefCI |
Definition at line 138 of file SVNumXRef.hpp.
typedef std::pair<NAVNumXRefCI,NAVNumXRefCI> gnsstk::NAVNumXRefPair |
Definition at line 139 of file SVNumXRef.hpp.
typedef std::set<NavSatelliteID> gnsstk::NavSatelliteIDSet |
Definition at line 174 of file NavSatelliteID.hpp.
typedef std::map<NavSatelliteID, NavMap> gnsstk::NavSatMap |
Map satellite to nav data.
Definition at line 69 of file NavData.hpp.
typedef EnumIterator<NavSearchOrder, NavSearchOrder::Unknown, NavSearchOrder::Last> gnsstk::NavSearchOrderIterator |
Define an iterator so C++11 can do things like for (NavSearchOrder i : NavSearchOrderIterator())
Definition at line 61 of file NavSearchOrder.hpp.
typedef std::set<NavSignalID> gnsstk::NavSignalSet |
Set of nav data signal identifiers.
Definition at line 107 of file NavSignalID.hpp.
Define an iterator so C++11 can do things like for (NavType i : NavTypeIterator())
Definition at line 79 of file NavType.hpp.
typedef EnumIterator<NavValidityType, NavValidityType::Unknown, NavValidityType::Last> gnsstk::NavValidityTypeIterator |
Define an iterator so C++11 can do things like for (NavValidityType i : NavValidityTypeIterator())
Definition at line 64 of file NavValidityType.hpp.
Wrapper for the Univeristy of New Brunswick trop model.
Definition at line 141 of file TropCorrector.hpp.
Wrapper for the A.E. Neill trop model.
Definition at line 147 of file TropCorrector.hpp.
typedef std::map<CommonTime, ObsEpoch> gnsstk::ObsEpochMap |
A time history of the observations collected from a single receiver.
Definition at line 67 of file ObsEpochMap.hpp.
typedef EnumIterator<ObservationType, ObservationType::Unknown, ObservationType::Last> gnsstk::ObservationTypeIterator |
Define an iterator so C++11 can do things like for (ObservationType i : ObservationTypeIterator())
Definition at line 79 of file ObservationType.hpp.
typedef std::map<gnsstk::CommonTime, gnsstk::ORDEpoch> gnsstk::ORDEpochMap |
Definition at line 114 of file ORDEpoch.hpp.
typedef std::shared_ptr<PackedNavBits> gnsstk::PackedNavBitsPtr |
Managed pointer for passing PackedNavBits around.
Definition at line 66 of file PackedNavBits.hpp.
typedef std::map<NavType, PNBNavDataFactoryPtr> gnsstk::PNBNavDataFactoryMap |
Map the navigation message type to a factory for producing that type.
Definition at line 140 of file PNBNavDataFactory.hpp.
typedef std::shared_ptr<PNBNavDataFactory> gnsstk::PNBNavDataFactoryPtr |
Managed pointer to a PNBNavDataFactory.
Definition at line 138 of file PNBNavDataFactory.hpp.
typedef EnumIterator<ReferenceFrame, ReferenceFrame::Unknown, ReferenceFrame::Last> gnsstk::ReferenceFrameIterator |
Define an iterator so C++11 can do things like for (ReferenceFrame i : ReferenceFrameIterator())
Definition at line 83 of file ReferenceFrame.hpp.
using gnsstk::RefFramePair = typedef std::pair<RefFrame, RefFrame> |
A little something to use for TransformerMap.
Definition at line 117 of file RefFrame.hpp.
typedef EnumIterator<RefFrameRlz, RefFrameRlz::Unknown, RefFrameRlz::Last> gnsstk::RefFrameRlzIterator |
Define an iterator so C++11 can do things like for (RefFrameRlz i : RefFrameRlzIterator())
Definition at line 77 of file RefFrameRlz.hpp.
typedef EnumIterator<RefFrameSys, RefFrameSys::Unknown, RefFrameSys::Last> gnsstk::RefFrameSysIterator |
Define an iterator so C++11 can do things like for (RefFrameSys i : RefFrameSysIterator())
Definition at line 63 of file RefFrameSys.hpp.
typedef std::binary_function<RinexMetData, RinexMetData, bool> gnsstk::RinexMetDataBinaryOperator |
Definition at line 60 of file RinexMetFilterOperators.hpp.
Wrapper for the Saastamoinen trop model.
Definition at line 139 of file TropCorrector.hpp.
typedef EnumIterator<SatelliteSystem, SatelliteSystem::Unknown, SatelliteSystem::Last> gnsstk::SatelliteSystemIterator |
Define an iterator so C++11 can do things like for (SatelliteSystem i : SatelliteSystemIterator())
Definition at line 74 of file SatelliteSystem.hpp.
Wrapper for the "simple" trop model.
Definition at line 137 of file TropCorrector.hpp.
typedef BasicStreamBuf<char, std::char_traits<char> > gnsstk::StreamBuf |
Definition at line 175 of file StreamBuf.hpp.
Define an iterator so C++11 can do things like for (SVHealth i : SVHealthIterator())
Definition at line 67 of file SVHealth.hpp.
typedef std::multimap<int, XRefNode>::const_iterator gnsstk::SVNumXRefListCI |
Definition at line 136 of file SVNumXRef.hpp.
typedef std::pair<SVNumXRefListCI,SVNumXRefListCI> gnsstk::SVNumXRefPair |
Definition at line 137 of file SVNumXRef.hpp.
typedef std::set<TimeCvtKey> gnsstk::TimeCvtSet |
Define a unique set of time system conversions.
Definition at line 55 of file TimeOffsetData.hpp.
typedef EnumIterator<TimeOffsetFilter, TimeOffsetFilter::Unknown, TimeOffsetFilter::Last> gnsstk::TimeOffsetFilterIterator |
Define an iterator so C++11 can do things like for (TimeOffsetFilter i : TimeOffsetFilterIterator())
Definition at line 63 of file TimeOffsetFilter.hpp.
Define an iterator so C++11 can do things like for (TimeSystem i : TimeSystemIterator())
Definition at line 76 of file TimeSystem.hpp.
typedef EnumIterator<TrackingCode, TrackingCode::Unknown, TrackingCode::Last> gnsstk::TrackingCodeIterator |
Define an iterator so C++11 can do things like for (TrackingCode i : TrackingCodeIterator())
Definition at line 192 of file TrackingCode.hpp.
using gnsstk::TransformerHist = typedef std::map<CommonTime, TransformerPtr> |
Transformers may change over time while maintaining the same RefFrames.
Definition at line 165 of file Transformer.hpp.
using gnsstk::TransformerMap = typedef std::map<RefFramePair, TransformerHist> |
Container of transformers for management.
Definition at line 167 of file Transformer.hpp.
using gnsstk::TransformerPtr = typedef std::shared_ptr<Transformer> |
Shared pointer to Transformer object.
Definition at line 163 of file Transformer.hpp.
typedef ValidType<char> gnsstk::vchar |
Definition at line 109 of file ValidType.hpp.
typedef ValidType<double> gnsstk::vdouble |
Definition at line 108 of file ValidType.hpp.
typedef ValidType<float> gnsstk::vfloat |
Definition at line 107 of file ValidType.hpp.
typedef ValidType<int> gnsstk::vint |
Definition at line 111 of file ValidType.hpp.
typedef ValidType<long> gnsstk::vlong |
Definition at line 112 of file ValidType.hpp.
typedef ValidType<short> gnsstk::vshort |
Definition at line 110 of file ValidType.hpp.
typedef ValidType<unsigned char> gnsstk::vuchar |
Definition at line 113 of file ValidType.hpp.
typedef ValidType<unsigned int> gnsstk::vuint |
Definition at line 115 of file ValidType.hpp.
typedef ValidType<unsigned long> gnsstk::vulong |
Definition at line 116 of file ValidType.hpp.
typedef ValidType<unsigned short> gnsstk::vushort |
Definition at line 114 of file ValidType.hpp.
typedef std::map<CommonTime, WxObservation> gnsstk::WxObsMap |
This is a map of weather observations over time. The key should be the same time as the time of the epoch.
Definition at line 115 of file WxObsMap.hpp.
Define an iterator so C++11 can do things like for (XmitAnt i : XmitAntIterator())
Definition at line 64 of file XmitAnt.hpp.
Somewhat pointless wrapper for zero trop correction model.
Definition at line 135 of file TropCorrector.hpp.
|
strong |
Definition at line 54 of file CarrierBand.hpp.
|
strong |
Values for Word TO in the almanac data.
Enumerator | |
---|---|
Unknown | Unknown/Uninitialized value. |
Circ19100 | Circular orbit of 19,100km. |
Definition at line 47 of file GLOCOrbitType.hpp.
|
strong |
Regime for data generation (RjE, RjT, see ICD 5.2.2.8).
Enumerator | |
---|---|
Unknown | Unknown/Uninitialized value. |
Relay | |
Prediction | |
Intersat |
Definition at line 47 of file GLOCRegime.hpp.
|
strong |
Values for Word M in the ephemeris (immediate) and almanac data.
Definition at line 47 of file GLOCSatType.hpp.
|
strong |
This enum encapsulates the choice of IERS Convention, which applies directly to the operation of class EarthOrientation, and is used in class SolarSystem and in the functions defined in SolidEarthTides.cpp. The IERS convention determines the precise form of frame transformations between the conventional terrestrial frame and the conventional inertial frame, as well as the solid earth tides.
References: IERS1996: IERS Technical Note 21, "IERS Conventions (1996)," Dennis D. McCarthy, U.S. Naval Observatory, 1996. IERS2003: IERS Technical Note 32, "IERS Conventions (2003)," Dennis D. McCarthy and Gerard Petit eds., U.S. Naval Observatory and Bureau International des Poids et Mesures, 2004. IERS2010: IERS Technical Note 36, "IERS Conventions (2010)," Gerard Petit and Brian Luzum eds., Bureau International des Poids et Mesures and U.S. Naval Observatory, 2010.
Enumerator | |
---|---|
Unknown | |
IERS1996 | |
IERS2003 | |
IERS2010 | |
Last |
Definition at line 69 of file IERSConvention.hpp.
enum gnsstk::LogLevel |
levels that the user may give the log stream output in the output statement, e.g. LOG(ERROR) << "This is an error message"; DEBUGn levels appear indented by 2*n spaces in the log stream. Default level is INFO.
Enumerator | |
---|---|
ERROR | |
WARNING | |
INFO | |
VERBOSE | |
DEBUG | |
DEBUG1 | |
DEBUG2 | |
DEBUG3 | |
DEBUG4 | |
DEBUG5 | |
DEBUG6 | |
DEBUG7 |
Definition at line 57 of file logstream.hpp.
|
strong |
Supported navigation types.
Definition at line 58 of file NavType.hpp.
|
strong |
The type of observation, mostly used by ObsID.
Definition at line 55 of file ObservationType.hpp.
|
strong |
ECEF reference systems or frames.
Definition at line 52 of file ReferenceFrame.hpp.
|
strong |
Supported satellite systems.
Definition at line 55 of file SatelliteSystem.hpp.
enum gnsstk::TableEntry |
Enumerator | |
---|---|
ZP | |
ZT | |
ZW | |
ZB | |
ZL | |
Mad | |
Mbd | |
Mcd | |
Maw | |
Mbw | |
Mcw |
Definition at line 98 of file NBTropModel.cpp.
|
strong |
Definition of various time systems.
Definition at line 51 of file TimeSystem.hpp.
|
strong |
The code used to collect the observation. Each of these should uniquely identify a code that was correlated against to track the signal. While the notation generally follows section 5.1 of RINEX 3, due to ambiguities in that specification some extensions are made. Note that as concrete specifications for the codes are released, this list may need to be adjusted. Specifically, this lists assumes that the same I & Q codes will be used on all three of the Galileo carriers. If that is not true, more identifiers need to be allocated
Definition at line 64 of file TrackingCode.hpp.
|
strong |
Enumerate satellite (pseudolite, etc.) transmitting antenna types. Most will be "Standard", while a few satellites will have secondary "Regional" transmitters. The secondary, "Regional" transmitter should NOT be confused with the primary transmitter for a regional system such as QZSS or NavIC.
Enumerator | |
---|---|
Unknown | Unitialized value. Should always be first. |
Any | When making comparisons in ObsID, matches any enumeration. |
Standard | Transmitting antenna is the primary for that signal. |
Regional | Transmitting antenna is secondary, regional coverage. |
Last | Used to verify that all items are described at compile time. |
Definition at line 53 of file XmitAnt.hpp.
|
inlinenoexcept |
Definition at line 156 of file GPS_URA.hpp.
|
inlinenoexcept |
Definition at line 112 of file GPS_URA.hpp.
double gnsstk::ADtest | ( | double * | xd, |
const int | nd, | ||
double | m, | ||
double | s, | ||
bool | save_flag = true |
||
) |
Anderson-Darling test statistic, which is a variant of the Kolmogorov-Smirnoff test, comparing the distribution of data with mean m and standard deviation s to the normal distribution.
xd | array of data. |
nd | length of array xd. |
m | mean of the data. |
s | standard deviation of the data. |
save_flag | if true (default) array xd will NOT be changed, otherwise it will be sorted. |
Exception |
Definition at line 561 of file RobustStats.cpp.
double gnsstk::ARand | ( | double | low, |
double | hi | ||
) |
Return random doubles between low and hi. Seed the generator by calling Rand(seed) before this call.
Definition at line 178 of file random.cpp.
int gnsstk::ARand | ( | int | low, |
int | hi | ||
) |
Return random integers between low and hi. Seed the generator by calling Rand(seed) before this call.
Definition at line 163 of file random.cpp.
double gnsstk::beta | ( | double | x, |
double | y | ||
) |
Beta function. Beta(x,y)=Beta(y,x)=integral(0 to 1) {t^(x-1)*(1-t)^(y-1) dt}. Also, Beta(x,y) = gamma(x)*gamma(y)/gamma(x+y).
x | first argument |
y | second argument |
Exception | if either input argument is <= 0 |
Definition at line 204 of file SpecialFuncs.cpp.
double gnsstk::binomialCoeff | ( | int | n, |
int | k | ||
) |
Binomial coefficient (n k) = n!/[k!(n-k)!], 0 <= k <= n. (n k) is the number of combinations of n things taken k at a time. NB. (n+1 k) = [ (n+1)/(n-k+1) ] (n k) = (n k) + (n k-1) NB. (n k+1) = [ (n-k)/(k+1) ] (n k)
n | int n must be >= 0 |
k | int k must be >= 0 and <= n |
Exception | if the input argument do not satisfy 0 <= k <= n |
Definition at line 177 of file SpecialFuncs.cpp.
|
inline |
Block diagonal concatenation of matrix input.
MatrixException |
Definition at line 436 of file MatrixOperators.hpp.
|
inline |
MatrixException |
Definition at line 472 of file MatrixOperators.hpp.
|
inline |
MatrixException |
Definition at line 481 of file MatrixOperators.hpp.
|
inline |
Convert a temperature from Celsius to Fahrenheit
c | Temperature in degrees Celsius |
Definition at line 86 of file convhelp.hpp.
double gnsstk::cfIBeta | ( | double | x, |
double | a, | ||
double | b | ||
) |
Routine used internally for Incomplete beta function I_x(a,b)
Exception | On overflow of temp arrays |
Definition at line 434 of file SpecialFuncs.cpp.
double gnsstk::ChisqCDF | ( | double | x, |
int | n | ||
) |
Cumulative distribution function (CDF) of the Chi-square-distribution. Ref http://www.itl.nist.gov/div898/handbook/ 1.3.6.6.6
x | input statistic value, the RSS of variances, X >= 0 |
n | degrees of freedom of sample, n > 0 |
Exception | if x < 0 or n <= 0, or math throws |
Definition at line 760 of file SpecialFuncs.cpp.
double gnsstk::ChisqPDF | ( | double | x, |
int | n | ||
) |
Probability density function (PDF) of the Chi-square distribution. The chi-square distribution results when n independent variables with standard normal distributions are squared and summed; x=RSS(variables).
A chi-square test (Snedecor and Cochran, 1983) can be used to test if the standard deviation of a population is equal to a specified value. This test can be either a two-sided test or a one-sided test. The two-sided version tests against the alternative that the true standard deviation is either less than or greater than the specified value. The one-sided version only tests in one direction. The chi-square hypothesis test is defined as: H0: sigma = sigma0 Ha: sigma < sigma0 for a lower one-tailed test sigma > sigma0 for an upper one-tailed test sigma <>sigma0 for a two-tailed test Test Statistic: T = T = (N-1)*(s/sigma0)**2 where N is the sample size and s is the sample standard deviation. The key element of this formula is the ratio s/sigma0 which compares the ratio of the sample standard deviation to the target standard deviation. As this ratio deviates from 1, the more likely is rejection of the null hypothesis. Significance Level: alpha. Critical Region: Reject the null hypothesis that the standard deviation is a specified value, sigma0, if T > chisquare(alpha,N-1) for an upper one-tailed alternative T < chisquare(1-alpha,N-1) for a lower one-tailed alternative T < chisquare(1-alpha,N-1) for a two-tailed test or T < chisquare(1-alpha,N-1) where chi-square(p,N-1) is the critical value or inverseCDF of the chi-square distribution with N-1 degrees of freedom.
x | input statistic, equal to an RSS(); x >= 0 |
n | input value for number of degrees of freedom, n > 0 |
Exception | if x < 0 or n <= 0, or math throws |
Definition at line 732 of file SpecialFuncs.cpp.
double gnsstk::compErrorFunc | ( | double | x | ) |
Complementary error function erfc(x). erfc(x) = 1-erf(x)
x | input argument |
Exception | if input argument < 0 |
Definition at line 415 of file SpecialFuncs.cpp.
double gnsstk::compIncompGamma | ( | double | a, |
double | x | ||
) |
Complement of incomplete gamma function Q(a,x), a > 0, x >= 0. Q(a,x) = (1/gamma(a)) integral (x to inf) { exp(-t) t^(a-1) dt }
a | first argument, a > 0 |
x | second argument, x >= 0 |
Exception | if input arguments have a <= 0 or x < 0 |
Definition at line 366 of file SpecialFuncs.cpp.
|
static |
Definition at line 274 of file EarthOrientation.cpp.
Triple gnsstk::computePolarTides | ( | const Position & | site, |
const EphTime & | ttag, | ||
double | xp, | ||
double | yp, | ||
const IERSConvention & | iers = IERSConvention::IERS2010 |
||
) |
Compute the site displacement due to rotational deformation due to polar motion for the given Position (assumed to fixed to the solid Earth) at the given time, given the polar motion angles at time (cf.EarthOrientation) and the IERS convention to use. Return a Triple containing the site displacement in ECEF XYZ coordinates with units meters. Reference IERS Conventions (1996) found in IERS Technical Note 21, ch. 7 pg 67.
site | Nominal position of the site of interest. |
ttag | Time of interest. |
xp,yp | Polar motion angles in arcsec (cf. EarthOrientation) |
iers | IERS convention to use (default IERS2010) |
Exception |
Definition at line 711 of file SolidEarthTides.cpp.
Triple gnsstk::computeSolidEarthTides | ( | const Position & | site, |
const EphTime & | ttag, | ||
const Position & | Sun, | ||
const Position & | Moon, | ||
double | EMRAT = 81.30056 , |
||
double | SERAT = 332946.050894783285912 , |
||
const IERSConvention & | iers = IERSConvention::IERS2010 |
||
) |
Compute the site displacement due to solid Earth tides for the given Position (assumed to be fixed to the solid Earth) at the given time, given the position of the site of interest, positions and mass ratios of the sun and moon. Return a Triple containing the site displacement in ECEF XYZ coordinates with units meters. Reference IERS Conventions (1996) found in IERS Technical Note 21 and IERS Conventions (2003) found in IERS Technical Note 32 and IERS Conventions (2010) found in IERS Technical Note 36. NB. Currently only the largest terms are implemented, yielding a result accurate to the millimeter level. Specifically, TN21 pg 61 eq 8 and TN21 pg 65 eq 17.
site | Nominal position of the site of interest. |
ttag | Time of interest. |
Sun | Position of the Sun at time |
Moon | Position of the Moon at time |
EMRAT | Earth-to-Moon mass ratio (default to DE405 value) |
SERAT | Sun-to-Earth mass ratio (default to DE405 value) |
iers | IERS convention to use (default IERS2010) |
Exception |
Definition at line 80 of file SolidEarthTides.cpp.
|
inlinenoexcept |
returns the condition number of the matrix, doesnt require bigNum or smallNum.
Definition at line 383 of file MatrixOperators.hpp.
|
inlinenoexcept |
returns the condition number of the matrix
Definition at line 364 of file MatrixOperators.hpp.
double gnsstk::contfracIncompGamma | ( | double | a, |
double | x | ||
) |
Incomplete gamma function Q(a,x), evaluated using continued fractions. Q(a,x) = (1/gamma(a)) integral (x to inf) { exp(-t) t^(a-1) dt }
a | first argument, a > 0 |
x | second argument, x >= 0 |
Exception | if input arguments have a <= 0 or x < 0 |
Definition at line 268 of file SpecialFuncs.cpp.
long gnsstk::convertCalendarToJD | ( | int | iyear, |
int | imonth, | ||
int | iday | ||
) |
Fundamental routine to convert from calendar day to "Julian day" (= JD + 0.5)
iyear | reference to integer year |
imonth | reference to integer month (January == 1) |
iday | reference to integer day of month (1st day of month == 1) |
Definition at line 100 of file TimeConverters.cpp.
|
inline |
Translate nav type enumeration to its string representation.
[in] | s | The nav type to get the string name of. |
Definition at line 98 of file NavType.hpp.
|
inline |
Translate system enumeration to its string representation.
[in] | s | The system to get the string name of. |
Definition at line 96 of file SatelliteSystem.hpp.
void gnsstk::convertSODtoTime | ( | double | sod, |
int & | hh, | ||
int & | mm, | ||
double & | sec | ||
) |
Fundamental routine to convert seconds of day to H:M:S
sod | seconds of day (input) |
hh | reference to integer hour (0 <= hh < 24) (output) |
mm | reference to integer minutes (0 <= mm < 60) (output) |
sec | reference to double seconds (0 <= sec < 60.0) (output) |
Definition at line 149 of file TimeConverters.cpp.
Translate nav type names as strings into enumeration equivalents.
[in] | s | The nav type name to convert to enumeration. |
Definition at line 109 of file NavType.hpp.
|
inline |
Translate GNSS names as strings into system enumeration equivalents.
[in] | s | The GNSS name to convert to enumeration. |
Definition at line 107 of file SatelliteSystem.hpp.
double gnsstk::convertTimeToSOD | ( | int | hh, |
int | mm, | ||
double | sec | ||
) |
Fundamental routine to convert H:M:S to seconds of day
hh | integer hour (0 <= hh < 24) (input) |
mm | integer minutes (0 <= mm < 60) (input) |
sec | double seconds (0 <= sec < 60.0) (input) |
Definition at line 175 of file TimeConverters.cpp.
|
static |
Definition at line 742 of file EarthOrientation.cpp.
|
static |
Definition at line 516 of file EarthOrientation.cpp.
|
static |
Definition at line 629 of file EarthOrientation.cpp.
|
static |
Definition at line 327 of file EarthOrientation.cpp.
|
inline |
finds the cosine between the two vectors
Definition at line 238 of file VectorBaseOperators.hpp.
T gnsstk::cosVec | ( | const SparseVector< T > & | S1, |
const SparseVector< T > & | S2 | ||
) |
Definition at line 736 of file SparseVector.hpp.
T gnsstk::cosVec | ( | const SparseVector< T > & | SV, |
const Vector< T > & | V | ||
) |
Definition at line 758 of file SparseVector.hpp.
T gnsstk::cosVec | ( | const Vector< T > & | V, |
const SparseVector< T > & | SV | ||
) |
Definition at line 780 of file SparseVector.hpp.
class BaseClass2 Vector<T> gnsstk::cross | ( | const ConstVectorBase< T, BaseClass > & | l, |
const ConstVectorBase< T, BaseClass2 > & | r | ||
) |
Definition at line 170 of file VectorOperators.hpp.
void gnsstk::crudeSolarPosition | ( | const CommonTime & | t, |
double & | lat, | ||
double & | lon | ||
) |
Compute the latitude and longitude of the Sun using a very simple algorithm. Adapted from sunpos by D. Coco ARL:UT 12/15/94
t | Input epoch of interest |
lat | Output latitude of the Sun at t |
lon | Output longitude of the Sun at t |
Definition at line 159 of file SolarPosition.cpp.
|
inline |
Convert a phase and frequency to meters
phase | Phase in cycles (radians?) |
freq | Frequency in Hertz |
ellipsoid | geodetic parameters (for c) |
Definition at line 62 of file convhelp.hpp.
std::string gnsstk::demangle | ( | const char * | name | ) |
Demangle G++ class names.
Definition at line 47 of file demangle.cpp.
|
inline |
Uses an LU Decomposition to calculate the determinate of m.
MatrixException |
Definition at line 345 of file MatrixOperators.hpp.
|
inline |
Returns the diagonal matrix of m
.
MatrixException |
Definition at line 414 of file MatrixOperators.hpp.
int gnsstk::DiscontinuityCorrector | ( | SatPass & | SP, |
GDCconfiguration & | config, | ||
std::vector< std::string > & | EditCmds, | ||
std::string & | retMsg, | ||
int | GLOn = -99 |
||
) |
GNSSTK Discontinuity Corrector. Find, and fix if possible, discontinuities in the GPS or GLONASS carrier phase data, given dual-frequency pseudorange and phase data for an entire satellite pass. Input is the SatPass object holding the data, and a GDCconfiguration object giving the parameter values for the corrector. Output is in the form of a list of strings - editing commands - that can be parsed and applied using the GNSSTK Rinex Editor (see Prgm EditRinex and the RinexEditor class). Also, the L1 and L2 arrays in the input SatPass are corrected. The routine will mark bad points in the input data using the SatPass flag. Glonass satellites require a frequency channel integer; the caller may pass this in, or let the GDC compute it from the data - if it fails it returns -6.
SP | SatPass object containing the input data. |
config | GDCconfiguration object. |
EditCmds | vector<string> (output) containing RinexEditor commands. |
retMsg | string summary of results: see 'GDC' in output, class GDCreturn if retMsg is not empty on call, replace 'GDC' with retMsg. |
GLOn | GLONASS frequency channel (-7<=n<7), -99 means UNKNOWN |
codes are defined as follows. const int GLOfail = -6 failed to find the Glonass frequency channel const int BadInput = -5 input data does not have the required obs types const int NoData = -4 insufficient input data, or all data is bad const int FatalProblem = -3 DT is not set, or memory problem const int Singularity = -1 polynomial fit fails const int ReturnOK = 0 normal return
Exception |
Definition at line 698 of file DiscCorr.cpp.
void gnsstk::DisplayExtendedRinexObsTypes | ( | ostream & | s | ) |
Definition at line 1002 of file RinexObsHeader.cpp.
void gnsstk::DisplayExtendedRinexObsTypes | ( | std::ostream & | s | ) |
Pretty print a list of registered extended Rinex observation types.
void gnsstk::DisplayStandardRinexObsTypes | ( | ostream & | s | ) |
Definition at line 987 of file RinexObsHeader.cpp.
void gnsstk::DisplayStandardRinexObsTypes | ( | std::ostream & | s | ) |
Pretty print a list of standard Rinex observation types.
void gnsstk::DMsmootherUpdateWithControl | ( | Matrix< double > & | P, |
Vector< double > & | X, | ||
Matrix< double > & | Phinv, | ||
Matrix< double > & | Rw, | ||
Matrix< double > & | G, | ||
Vector< double > & | Zw, | ||
Matrix< double > & | Rwx, | ||
Vector< double > & | U | ||
) |
Definition at line 959 of file SRIFilter.cpp.
|
inline |
returns the dot product of the two vectors
Definition at line 167 of file VectorBaseOperators.hpp.
|
inline |
returns the dot product of a vector and a scalar
Definition at line 181 of file VectorBaseOperators.hpp.
T gnsstk::dot | ( | const SparseVector< T > & | SL, |
const SparseVector< T > & | SR | ||
) |
dot (SparseVector, SparseVector)
Definition at line 789 of file SparseVector.hpp.
T gnsstk::dot | ( | const SparseVector< T > & | SL, |
const Vector< T > & | SR | ||
) |
dot (SparseVector, Vector)
Definition at line 858 of file SparseVector.hpp.
|
inline |
returns the dot product of a scalar and a vector
Definition at line 194 of file VectorBaseOperators.hpp.
T gnsstk::dot | ( | const Vector< T > & | SL, |
const SparseVector< T > & | SR | ||
) |
dot (Vector, SparseVector)
Definition at line 874 of file SparseVector.hpp.
T gnsstk::dot_lim | ( | const SparseVector< T > & | SL, |
const SparseVector< T > & | SR, | ||
const unsigned int | kb, | ||
const unsigned int | ke | ||
) |
dot (SparseVector, SparseVector) but only use indexes k=kb, k<ke
Definition at line 820 of file SparseVector.hpp.
void gnsstk::dump | ( | std::vector< SatPass > & | SatPassList, |
std::ostream & | os, | ||
bool | rev = false , |
||
bool | dbug = false |
||
) |
void gnsstk::dump | ( | vector< SatPass > & | SatPassList, |
ostream & | os, | ||
bool | rev, | ||
bool | dbug | ||
) |
Definition at line 59 of file SatPassUtilities.cpp.
void gnsstk::dumpAllRinex3ObsTypes | ( | ostream & | os | ) |
Definition at line 764 of file Rinex3ObsFileLoader.cpp.
void gnsstk::dumpAllRinex3ObsTypes | ( | std::ostream & | s | ) |
Utility to dump a table of all valid RinexObsIDs for all systems and frequencies
s | to which to write the data |
T gnsstk::errfc | ( | T | x | ) |
Approximation to complimentary error function with fractional error everywhere less than 1.2e-7. Ref. Numerical Recipes part 6.2. NB. error function erf = 1-erfc
x | input argument. |
Definition at line 292 of file RobustStats.hpp.
double gnsstk::errorFunc | ( | double | x | ) |
Error function erf(x). erf(x) = 2/sqrt(pi) * integral (0 to x) { exp(-t^2) dt }
x | input argument |
Exception | if input argument < 0 |
Definition at line 396 of file SpecialFuncs.cpp.
void gnsstk::expand_args | ( | vector< string > & | oldvalues, |
vector< string > & | newvalues, | ||
string & | msg | ||
) |
Exception |
Definition at line 639 of file CommandLine.cpp.
void gnsstk::expand_filename | ( | std::string & | filename | ) |
void gnsstk::expand_filename | ( | std::vector< std::string > & | sarray | ) |
void gnsstk::expand_filename | ( | string & | filename | ) |
Definition at line 51 of file expandtilde.cpp.
void gnsstk::expand_filename | ( | vector< string > & | sarray | ) |
Definition at line 70 of file expandtilde.cpp.
bool gnsstk::expand_list_file | ( | std::string & | filename, |
std::vector< std::string > & | values | ||
) |
bool gnsstk::expand_list_file | ( | string & | filename, |
vector< string > & | values | ||
) |
Definition at line 95 of file expandtilde.cpp.
double gnsstk::factorial | ( | int | n | ) |
Factorial of an integer, returned as a double.
n | argument, n must be >= 0 |
Exception | if the input argument is < 0 |
Definition at line 114 of file SpecialFuncs.cpp.
|
inline |
Convert a temperature from Fahrenheit to Celsius
f | Temperature in degrees Fahrenheit |
Definition at line 97 of file convhelp.hpp.
double gnsstk::FDistCDF | ( | double | F, |
int | n1, | ||
int | n2 | ||
) |
F-distribution cumulative distribution function FDistCDF(F,n1,n2) F>=0 n1,n2>0. This function occurs in the statistical test of whether two observed samples have the same variance. If F is the ratio of the observed dispersion (variance) of the first sample to that of the second, where the first sample has n1 degrees of freedom and the second has n2 degrees of freedom, then this function returns the probability that F would be as large as it is if the first sample's distribution has smaller variance than the second's. In other words, FDistCDF(f,n1,n2) is the significance level at which the hypothesis "sample 1 has smaller variance than sample 2" can be rejected. A small numerical value implies a significant rejection, in turn implying high confidence in the hypothesis "sample 1 has variance greater than or equal to that of sample 2". Ref http://www.itl.nist.gov/div898/handbook/ 1.3.6.6.5
F | input statistic value, the ratio variance1/variance2, F >= 0 |
n1 | degrees of freedom of first sample, n1 > 0 |
n2 | degrees of freedom of second sample, n2 > 0 |
Exception | if F<0 or n1 <=0 or n2 <= 0 or math throws |
Definition at line 1050 of file SpecialFuncs.cpp.
double gnsstk::FDistPDF | ( | double | x, |
int | n1, | ||
int | n2 | ||
) |
Probability density function for F distribution The F distribution is the ratio of two chi-square distributions with degrees of freedom N1 and N2, respectively, where each chi-square has first been divided by its degrees of freedom. An F-test (Snedecor and Cochran, 1983) is used to test if the standard deviations of two populations are equal. This test can be a two-tailed test or a one-tailed test. The F hypothesis test is defined as: H0: s1 = s2 (sN is sigma or std deviation) Ha: s1 < s2 for a lower one tailed test s1 > s2 for an upper one tailed test s1 != s2 for a two tailed test Test Statistic: F = s1^2/s2^2 where s1^2 and s2^2 are the sample variances. The more this ratio deviates from 1, the stronger the evidence for unequal population variances. Significance Level is alpha, a probability (0<=alpha<=1). The hypothesis that the two standard deviations are equal is rejected if F > PP(alpha,N1-1,N2-1) for an upper one-tailed test F < PP(1-alpha,N1-1,N2-1) for a lower one-tailed test F < PP(1-alpha/2,N1-1,N2-1) for a two-tailed test F > PP(alpha/2,N1-1,N2-1) where PP(alpha,k-1,N-1) is the percent point function of the F distribution [PPfunc is inverse of the CDF : PP(alpha,N1,N2) == F where alpha=CDF(F,N1,N2)] with N1 and N2 degrees of freedom and a significance level of alpha.
Ref http://www.itl.nist.gov/div898/handbook/ 1.3.6.6.5
x | probability or significance level of the test, >=0 and < 1 |
n1 | degrees of freedom of first sample, n1 > 0 |
n2 | degrees of freedom of second sample, n2 > 0 |
Exception | if math or Gamms() throw |
Definition at line 1103 of file SpecialFuncs.cpp.
int gnsstk::findMilliseconds | ( | std::vector< SatPass > & | SPList, |
msecHandler & | msh | ||
) |
int gnsstk::findMilliseconds | ( | vector< SatPass > & | SPList, |
msecHandler & | msh | ||
) |
Definition at line 135 of file SatPassUtilities.cpp.
double gnsstk::Gamma | ( | double | x | ) |
Gamma(x) the gamma function for positive argument. Gamma(x) = integral(0 to inf) { t^(x-1) exp(-t) dt }
x | argument, x must be > 0 |
Exception | if the input argument is <= 0 |
Definition at line 98 of file SpecialFuncs.cpp.
|
inlinenoexcept |
Compute alpha (also called gamma) = (beta^2-1) = ((fa/fb)^2-1) for 2 frequencies fa,fb for the given satellite system (sat.id is ignored).
Definition at line 286 of file FreqConsts.hpp.
|
inlinenoexcept |
Compute beta(a,b), the ratio of 2 frequencies fb/fa for the given satellite system.
Definition at line 271 of file FreqConsts.hpp.
double gnsstk::getFrequency | ( | CarrierBand | band | ) |
Get the carrier frequency in Hz for a given carrier band enumeration.
[in] | band | The carrier band whose carrier frequency is needed. |
Definition at line 43 of file FreqConv.cpp.
double gnsstk::getGamma | ( | CarrierBand | band1, |
CarrierBand | band2 | ||
) |
Get the gamma value relative to two carrier bands, which is (f1/f2)^2.
[in] | band1 | The primary carrier band in a dual-frequency observation. |
[in] | band2 | The secondary carrier band in a dual-frequency observation. |
Definition at line 67 of file FreqConv.cpp.
Return the number of leap seconds between UTC and TAI, that is the difference in time scales UTC-TAI, at an epoch defined by year/month/day.
[in] | yr | year of interest |
[in] | mon | month of interest |
[in] | day | day of interest |
Definition at line 53 of file TimeSystem.cpp.
Definition at line 111 of file GNSSconstants.hpp.
RefFrameRlz gnsstk::getRefFrameRlz | ( | RefFrameSys | sys, |
const CommonTime & | when | ||
) |
Return the realization for a given reference frame system and time.
[in] | sys | The reference frame system whose realization is requested. |
[in] | when | The time at which the reference frame realization would have been in use. Expected to be in UTC time system. |
InvalidRequest | if when is not in UTC. |
Definition at line 77 of file RefFrameRlz.cpp.
|
noexcept |
Return the system for a given reference frame realization.
[in] | rlz | The reference frame realization whose system is requested. |
Definition at line 48 of file RefFrameRlz.cpp.
double gnsstk::getTimeSystemCorrection | ( | const TimeSystem | inTS, |
const TimeSystem | outTS, | ||
const int | year, | ||
const int | month, | ||
const double | day | ||
) |
Compute the conversion (in seconds) from one time system (inTS) to another (outTS), given the year and month of the time to be converted. Result is to be added to the first time (inTS) to yield the second (outTS), that is t(outTS) = t(inTS) + correction(inTS,outTS).
[in] | inTS | input system |
[in] | outTS | output system |
[in] | year | year of the time to be converted. |
[in] | month | month (1-12) of the time to be converted. |
if | input system(s) are invalid or Unknown. |
Definition at line 181 of file TimeSystem.cpp.
|
inlinenoexcept |
Compute wavelength for the given satellite system (sat.id is ignored) at the given RINEX frequency band.
[in] | sys | The satellite system whose wavelength is desired. |
[in] | rinexBandNum | The number used by RINEX 3 to represent the desired band. |
[in] | gloChan | The GLONASS frequency channel number, when getting the wavelength for a GLONASS FDMA channel. Ignored for GLONASS CDMA and all other systems. |
Definition at line 191 of file FreqConsts.hpp.
|
static |
Definition at line 58 of file SolarPosition.cpp.
|
inline |
Convert pressure from inches of mercury to millibars
hg | Pressure in inches of mercury |
Definition at line 119 of file convhelp.hpp.
BaseClass& gnsstk::ident | ( | RefMatrixBase< T, BaseClass > & | m | ) |
Turns the square RefMatrixBase matrix into an identity matrix
MatrixException |
Definition at line 80 of file MatrixBaseOperators.hpp.
|
inline |
Returns a new dim
* dim
matrix that's an identity matrix.
MatrixException |
Definition at line 395 of file MatrixOperators.hpp.
Definition at line 331 of file Namelist.cpp.
SparseMatrix< T > gnsstk::identSparse | ( | const unsigned int | dim | ) |
Compute the identity matrix of dimension dim x dim
dim | dimension of desired identity matrix (dim x dim) |
Definition at line 1776 of file SparseMatrix.hpp.
void gnsstk::include_path | ( | std::string | path, |
std::string & | file | ||
) |
void gnsstk::include_path | ( | std::string | path, |
std::vector< std::string > & | sarray | ||
) |
void gnsstk::include_path | ( | string | path, |
string & | file | ||
) |
Definition at line 75 of file expandtilde.cpp.
void gnsstk::include_path | ( | string | path, |
vector< string > & | sarray | ||
) |
Definition at line 84 of file expandtilde.cpp.
double gnsstk::incompGamma | ( | double | a, |
double | x | ||
) |
Incomplete gamma function P(a,x), a,x > 0. P(a,x) = (1/gamma(a)) integral (0 to x) { exp(-t) t^(a-1) dt }; a > 0, x >= 0
a | first argument, a > 0 |
x | second argument, x >= 0 |
Exception | if input arguments have a <= 0 or x < 0 |
Definition at line 332 of file SpecialFuncs.cpp.
double gnsstk::incompleteBeta | ( | double | x, |
double | a, | ||
double | b | ||
) |
Incomplete beta function I_x(a,b), 0<=x<=1, a,b>0 I_x (a,b) = (1/beta(a,b)) integral (0 to x) { t^(a-1)*(1-t)^(b-1)dt }
x | input value, 0 <= x <= 1 |
a | input value, a > 0 |
b | input value, b > 0 |
Exception | On overflow of temp arrays in cfIBeta |
Definition at line 499 of file SpecialFuncs.cpp.
void gnsstk::insert | ( | T * | sa, |
int | na, | ||
int(*)(const T &, const T &) | comp = gnsstk::Qsort_compare |
||
) |
Insert sort. operator>() and operator<() must be defined for T, and a user comparison function comp(T,T) may be passed to override the default Qsort_compare().
sa | is the array of type T to be sorted. |
na | length of the array to be sorted. |
comp | (optional) the comparison function to be used. |
Definition at line 111 of file RobustStats.hpp.
void gnsstk::insert | ( | T * | sa, |
S * | pa, | ||
int | na, | ||
int(*)(const T &, const T &) | comp = gnsstk::Qsort_compare |
||
) |
Insert sort one vector, keeping a second parallel. See the single-vector version of insert.
sa | is the array of type T to be sorted. |
pa | is the array of type S to be kept parallel to the first. |
na | length of the array to be sorted. |
Definition at line 198 of file RobustStats.hpp.
string gnsstk::int2bin | ( | unsigned int | v, |
int | len = 8 |
||
) |
Definition at line 423 of file EngAlmanac.cpp.
double gnsstk::invChisqCDF | ( | double | alpha, |
int | n | ||
) |
Chi-square-distribution percent point function, or inverse of the Chisq CDF. This function(alpha,N) == Y where alpha = ChisqCDF(Y,N). Ref http://www.itl.nist.gov/div898/handbook/ 1.3.6.6.6
alpha | probability or significance level of the test, >=0 and < 1 |
n | degrees of freedom of sample, n > 0 |
Exception | if alpha < 0 || >= 1, 1-alpha < eps, or fails to converge |
Definition at line 789 of file SpecialFuncs.cpp.
|
inline |
Inverts the matrix M by Gaussian elimination. Throws on non-square and singular matricies.
MatrixException |
Definition at line 519 of file MatrixOperators.hpp.
SparseMatrix< T > gnsstk::inverse | ( | const SparseMatrix< T > & | A | ) |
inverse (via Gauss-Jordan)
Exception | inverse via Gauss-Jordan; NB GJ involves only row operations. NB not the best numerically; for high condition number, use inverseViaCholesky, or cast to Matrix, use either LUD or SVD, then cast back to SparseMatrix. |
Exception |
Definition at line 1890 of file SparseMatrix.hpp.
|
inline |
Inverts the square symmetric positive definite matrix M using Cholesky-Crout algorithm. Very fast and useful when M comes from using a Least Mean-Square (LMS) or Weighted Least Mean-Square (WLMS) method.
MatrixException |
Definition at line 782 of file MatrixOperators.hpp.
Compute inverse of a symmetric positive definite matrix using Cholesky decomposition.
A | Matrix to be inverted; symmetric and positive definite, unchanged |
MatrixException | if input Matrix is not square |
SingularMatrixException | if input Matrix is singular |
Definition at line 601 of file SRIMatrix.hpp.
Matrix< T > gnsstk::inverseLT | ( | const Matrix< T > & | LT, |
T * | ptrSmall = NULL , |
||
T * | ptrBig = NULL |
||
) |
Compute inverse of lower triangular matrix, returning smallest and largest eigenvalues.
LT | lower triangular matrix to be inverted |
ptrSmall | pointer to <T> small, on output *ptrSmall contains smallest eigenvalue. |
ptrBig | pointer to <T> big, on output *ptrBig contains largest eigenvalue. |
MatrixException | if input is not square (assumed lower triangular also). |
SingularMatrixException | if input is singular. |
Definition at line 773 of file SRIMatrix.hpp.
SparseMatrix< T > gnsstk::inverseLT | ( | const SparseMatrix< T > & | LT, |
T * | ptrSmall, | ||
T * | ptrBig | ||
) |
Compute inverse of lower-triangular SparseMatrix.
inverseLT
Definition at line 2154 of file SparseMatrix.hpp.
|
inline |
Inverts the matrix M by LU decomposition. Throws on non-square and singular matricies.
MatrixException |
Definition at line 591 of file MatrixOperators.hpp.
|
inline |
Inverts the matrix M by LU decomposition, and returns determinant as well Throws on non-square and singular matricies.
MatrixException |
Definition at line 620 of file MatrixOperators.hpp.
|
inline |
Inverts the square matrix M by SVD, editing the singular values using tolerance tol. Throws only on input of the zero matrix.
MatrixException |
Definition at line 652 of file MatrixOperators.hpp.
|
inline |
Invert the square matrix M by SVD, editing the singular values with tolerance tol, and return the largest and smallest singular values (before any editing). Throws only on input of the zero matrix.
MatrixException |
Definition at line 691 of file MatrixOperators.hpp.
|
inline |
Invert the square matrix M by SVD, editing the singular values using tolerance tol, and return the singular values (before any editing). Throws only on input of the zero matrix.
MatrixException |
Definition at line 736 of file MatrixOperators.hpp.
Matrix< T > gnsstk::inverseUT | ( | const Matrix< T > & | UT, |
T * | ptrSmall = NULL , |
||
T * | ptrBig = NULL |
||
) |
Compute inverse of upper triangular matrix, returning smallest and largest eigenvalues.
UT | upper triangular matrix to be inverted |
ptrSmall | pointer to <T> small, on output *ptrSmall contains smallest eigenvalue. |
ptrBig | pointer to <T> big, on output *ptrBig contains largest eigenvalue. |
MatrixException | if input is not square (assumed upper triangular also). |
SingularMatrixException | if input is singular. |
Definition at line 636 of file SRIMatrix.hpp.
SparseMatrix< T > gnsstk::inverseViaCholesky | ( | const SparseMatrix< T > & | A | ) |
Exception | Compute inverse of a symmetric positive definite matrix using Cholesky decomposition. |
A | SparseMatrix to be inverted; symmetric and positive definite, const |
Exception | if input SparseMatrix is not square, not positive definite, or singular |
Definition at line 2277 of file SparseMatrix.hpp.
double gnsstk::invFDistCDF | ( | double | prob, |
int | n1, | ||
int | n2 | ||
) |
F-distribution percent point function, or inverse of the F-dist CDF. this function(prob,N1,N2) == F where prob = FDistCDF(F,N1,N2). Ref http://www.itl.nist.gov/div898/handbook/ 1.3.6.6.5
prob | probability or significance level of the test, >=0 and < 1 |
n1 | degrees of freedom of first sample, n1 > 0 |
n2 | degrees of freedom of second sample, n2 > 0 |
Exception | if prob < 0 || >=1 or n1<=0 or n2<=0 or 1-prob<eps |
Definition at line 1127 of file SpecialFuncs.cpp.
double gnsstk::invNormalCDF | ( | double | prob, |
double | mu, | ||
double | sig | ||
) |
Normal-distribution percent point function, or inverse of the Normal CDF. This function(prob,mu,sig) == X where prob = NormalCDF(X,mu,sig). Ref http://www.itl.nist.gov/div898/handbook/ 1.3.6.6.1
prob | probability or significance level of the test, >=0 and < 1 |
mu | mean of the sample (location parameter of the distribution) |
sig | std dev of the sample (scale parameter of the distribution) |
Exception | if prob < 0 || >= 1, if sig <= 0, if 1-prob < eps |
Definition at line 615 of file SpecialFuncs.cpp.
double gnsstk::invStudentsCDF | ( | double | prob, |
int | n | ||
) |
Students-t-distribution percent point function, or inverse of the Student CDF. This function(prob,n) == Y where prob = StudentsCDF(Y,n). Ref http://www.itl.nist.gov/div898/handbook/ 1.3.6.6.4
prob | probability or significance level of the test, >=0 and < 1 |
n | degrees of freedom of sample, n > 0 |
Exception | if prob < 0 || >= 1, n<=0 or 1-prob < eps |
Definition at line 950 of file SpecialFuncs.cpp.
Return true if the given SatID is BeiDou GEO (expecting D2 nav).
Definition at line 222 of file GNSSconstants.hpp.
bool gnsstk::isRinex3NavFile | ( | const std::string & | file | ) |
Determine if the given file is a RINEX 3 navigation file. Open the file, read the header, and test its validity.
file | the filename |
bool gnsstk::isRinex3NavFile | ( | const string & | file | ) |
Definition at line 235 of file RinexUtilities.cpp.
bool gnsstk::isRinex3ObsFile | ( | const std::string & | file | ) |
Determine if the given file is a RINEX 3 observation file. Open the file, read the header, and test its validity.
file | the filename |
bool gnsstk::isRinex3ObsFile | ( | const string & | file | ) |
Definition at line 311 of file RinexUtilities.cpp.
bool gnsstk::isRinexNavFile | ( | const std::string & | file | ) |
Determine if the given file is a RINEX clock format file.
file | the filename |
file | the filename |
bool gnsstk::isRinexNavFile | ( | const string & | file | ) |
Definition at line 200 of file RinexUtilities.cpp.
bool gnsstk::isRinexObsFile | ( | const std::string & | file | ) |
Determine if the given file is a RINEX observation file. Open the file, read the header, and test its validity.
file | the filename |
bool gnsstk::isRinexObsFile | ( | const string & | file | ) |
Definition at line 275 of file RinexUtilities.cpp.
bool gnsstk::isSP3File | ( | const std::string & | file | ) |
Determine if the given file is an SP3 format file.
file | the filename |
bool gnsstk::isSP3File | ( | const string & | file | ) |
Definition at line 165 of file RinexUtilities.cpp.
Determine if the given ObsID is valid, for the given system.
Definition at line 255 of file RinexObsID.cpp.
T gnsstk::LagrangeInterpolating2ndDerivative | ( | const std::vector< T > & | pos, |
const std::vector< T > & | val, | ||
const T | desiredPos | ||
) |
Returns the second derivative of Lagrange interpolation.
Definition at line 193 of file MiscMath.hpp.
T gnsstk::LagrangeInterpolation | ( | const std::vector< T > & | X, |
const std::vector< T > & | Y, | ||
const T & | x, | ||
T & | err | ||
) |
Lagrange interpolation on data (X[i],Y[i]), i=0,N-1 to compute Y(x). Also return an estimate of the estimation error in 'err'. This routine assumes that N=X.size() is even and that x is centered on the interval, that is X[N/2-1] <= x <= X[N/2].
Exception |
Definition at line 98 of file MiscMath.hpp.
void gnsstk::LagrangeInterpolation | ( | const std::vector< T > & | X, |
const std::vector< T > & | Y, | ||
const T & | x, | ||
T & | y, | ||
T & | dydx | ||
) |
Perform Lagrange interpolation on the data (X[i],Y[i]), i=1,N (N=X.size()), returning the value of Y(x) and dY(x)/dX. Assumes that x is between X[k-1] and X[k], where k=N/2 and N > 2;
Exception |
Definition at line 154 of file MiscMath.hpp.
Compute LDL (lower-diagonal-lower) decomposition of a square positive definite matrix. Return the lower triangular matrix L and the diagonal as a Vector<T>. The decomposition is such that A = L*diag(D)*transpose(L).
A | Matrix<T> to be decomposed, must be square and positive definite |
D | Vector<T> output diagonal matrix stored as a Vector |
MatrixException | if input is not square, |
SingularMatrixException | if input is not positive definite |
Definition at line 860 of file SRIMatrix.hpp.
double gnsstk::lnFactorial | ( | int | n | ) |
ln of Factorial of an integer, returned as a double.
n | argument, n must be >= 0 |
Exception | if the input argument is < 0 |
Definition at line 149 of file SpecialFuncs.cpp.
double gnsstk::lnGamma | ( | double | x | ) |
Natural log of the gamma function for positive argument. Gamma(x) = integral(0 to inf) { t^(x-1) exp(-t) dt }
x | argument, x must be > 0 |
Exception | if the input argument is <= 0 |
Definition at line 64 of file SpecialFuncs.cpp.
Matrix< T > gnsstk::lowerCholesky | ( | const Matrix< T > & | A, |
const T | ztol = T(1.e-16) |
||
) |
Compute lower triangular square root of a symmetric positive definite matrix (Cholesky decomposition) Crout algorithm.
A | Matrix to be decomposed; symmetric and positive definite, unchanged |
ztol | zero tolerance, defaults to 1.e-16 |
MatrixException | if input Matrix is not square |
SingularMatrixException | if input Matrix is not positive definite |
Definition at line 497 of file SRIMatrix.hpp.
SparseMatrix< T > gnsstk::lowerCholesky | ( | const SparseMatrix< T > & | A | ) |
Exception | Compute lower triangular square root of a symmetric positive definite matrix (Cholesky decomposition) Crout algorithm. |
A | SparseMatrix to be decomposed; symmetric and positive definite, const |
if | input SparseMatrix is not square |
if | input SparseMatrix is not positive definite |
Exception |
Definition at line 2065 of file SparseMatrix.hpp.
Position gnsstk::lunarPosition | ( | const CommonTime & | t, |
double & | AR | ||
) |
Compute the Position of the Moon in WGS84 ECEF coordinates. Ref. Astronomical Almanac 1990 D46
t | Input epoch of interest |
AR | Output apparent angular radius of moon as seen at Earth (deg) |
Definition at line 249 of file SolarPosition.cpp.
|
inline |
median absolute deviation of a gnsstk::Vector
|
inline |
SparseMatrix< T > gnsstk::matrixTimesTranspose | ( | const SparseMatrix< T > & | M | ) |
|
inline |
Returns the largest element of the vector
Definition at line 150 of file VectorBaseOperators.hpp.
T gnsstk::max | ( | const SparseMatrix< T > & | SM | ) |
Maximum element - return 0 if empty.
Definition at line 881 of file SparseMatrix.hpp.
T gnsstk::max | ( | const SparseVector< T > & | SV | ) |
Definition at line 895 of file SparseVector.hpp.
For gnsstk::max | ( | const std::list< For > & | lst | ) |
A simple way to get the max value of a list of numbers.
Definition at line 58 of file stl_helpers.hpp.
|
inlinenoexcept |
find the maximum magnitude in a matrix
Definition at line 951 of file MatrixOperators.hpp.
|
inline |
Return the element with largest absolute value in the vector
Definition at line 133 of file VectorBaseOperators.hpp.
T gnsstk::maxabs | ( | const SparseMatrix< T > & | SM | ) |
Maximum absolute value - return 0 if empty.
Definition at line 927 of file SparseMatrix.hpp.
T gnsstk::maxabs | ( | const SparseVector< T > & | SV | ) |
Definition at line 927 of file SparseVector.hpp.
|
inline |
Convert pressure from millibars to inches of mercury
mb | Pressure in millibars |
Definition at line 108 of file convhelp.hpp.
|
inline |
|
inline |
Convert a range and frequency to cycles
range | Distance in meters |
freq | Frequency in Hertz |
ellipsoid | geodetic parameters (for c) |
Definition at line 75 of file convhelp.hpp.
|
inline |
Returns the smallest element of the vector
VectorException |
Definition at line 116 of file VectorBaseOperators.hpp.
T gnsstk::min | ( | const SparseMatrix< T > & | SM | ) |
Maximum element - return 0 if empty.
Definition at line 858 of file SparseMatrix.hpp.
T gnsstk::min | ( | const SparseVector< T > & | SV | ) |
Definition at line 879 of file SparseVector.hpp.
For gnsstk::min | ( | const std::list< For > & | lst | ) |
A simple way to get the minimum value of a list of numbers.
Definition at line 64 of file stl_helpers.hpp.
|
inline |
Return the element with smallest absolute value in the vector
VectorException |
Definition at line 97 of file VectorBaseOperators.hpp.
T gnsstk::minabs | ( | const SparseMatrix< T > & | SM | ) |
Minimum absolute value - return 0 if empty.
Definition at line 904 of file SparseMatrix.hpp.
T gnsstk::minabs | ( | const SparseVector< T > & | SV | ) |
Definition at line 911 of file SparseVector.hpp.
|
inline |
return the Minkowski product of two vectors of length 4.
Definition at line 225 of file VectorBaseOperators.hpp.
|
inline |
Returns the minor matrix of l at element (row, col). A minor matrix is the same matrix as l
but with row row
and col col
removed.
MatrixException |
Definition at line 266 of file MatrixOperators.hpp.
void gnsstk::mixedScanTime | ( | CommonTime & | t, |
const std::string & | str, | ||
const std::string & | fmt | ||
) |
This function is like the other scanTime functions except that it allows mixed time formats. i.e. Year / 10-bit GPS week / seconds-of-week The time formats are filled in the following order: GPS Epoch, year, month, GPS Full Week, GPS 10-bit Week, day-of-week, day-of-month, day-of-year, 29-bit Zcount, 19-bit Zcount, hour, minute, second-of-week, second-of-day, second-of-minute.
void gnsstk::mixedScanTime | ( | CommonTime & | t, |
const string & | str, | ||
const string & | fmt | ||
) |
Definition at line 432 of file TimeString.cpp.
|
static |
Definition at line 101 of file NBTropModel.cpp.
gnsstk::NEW_EXCEPTION_CLASS | ( | EndOfFile | , |
gnsstk::FFStreamError | |||
) |
This gets thrown if a valid EOF occurs on formattedGetLine.
gnsstk::NEW_EXCEPTION_CLASS | ( | InvalidValue | , |
gnsstk::Exception | |||
) |
gnsstk::NEW_EXCEPTION_CLASS | ( | NoNAVSTARNumberFound | , |
gnsstk::Exception | |||
) |
gnsstk::NEW_EXCEPTION_CLASS | ( | NoPRNNumberFound | , |
gnsstk::Exception | |||
) |
gnsstk::NEW_EXCEPTION_CLASS | ( | SingularMatrixException | , |
MatrixException | |||
) |
Thrown when an operation can't be performed on a singular matrix.
|
inlinenoexcept |
Definition at line 134 of file GPS_URA.hpp.
|
inline |
returns the norm of the vector
Definition at line 207 of file VectorBaseOperators.hpp.
T gnsstk::norm | ( | const SparseVector< T > & | SV | ) |
Definition at line 705 of file SparseVector.hpp.
double gnsstk::NormalCDF | ( | double | x, |
double | mu, | ||
double | sig | ||
) |
Cumulative distribution function (CDF) of the Normal-distribution. Ref http://www.itl.nist.gov/div898/handbook/ 1.3.6.6.1
x | input statistic |
mu | mean of the sample (location parameter of the distribution) |
sig | std dev of the sample (scale parameter of the distribution) |
Exception | if sig <= 0 |
Definition at line 588 of file SpecialFuncs.cpp.
T gnsstk::normalCDF | ( | T | m, |
T | s, | ||
T | x | ||
) |
Cumulative distribution function CDF for the normal distribution with mean m and standard deviation s (square root of variance). Return 0 if s is zero.
m | mean of the distribution |
s | standard deviation (sqrt of variance) of the distribution, > 0. |
x | value at which to compute the CDF. |
Definition at line 321 of file RobustStats.hpp.
Vector<T> gnsstk::normalize | ( | const ConstVectorBase< T, BaseClass > & | l | ) |
returns a new vector with the normalized version of l
Definition at line 187 of file VectorOperators.hpp.
double gnsstk::NormalPDF | ( | double | x, |
double | mu, | ||
double | sig | ||
) |
Normal distribution of sample mean mu and sample std deviation sig (location and scale parameters, resp.).
For both theoretical and practical reasons, the normal distribution is probably the most important distribution in statistics. Many classical statistical tests are based on the assumption that the data follow a normal distribution. (This assumption should be tested before applying these tests.) In modeling applications, such as linear and non-linear regression, the error term is often assumed to follow a normal distribution with fixed location (mu) and scale (sig). The normal distribution is widely used. Part of its appeal is that it is well behaved and mathematically tractable. However, the central limit theorem provides a theoretical basis for why it has wide applicability. The central limit theorem states that as the sample size n becomes large, the following occur: The sampling distribution of the mean becomes approximately normal regardless of the distribution of the original variable. The sampling distribution of the mean is centered at the population mean, mu, of the original variable. In addition, the standard deviation of the sampling distribution of the mean approaches sig/sqrt(n). Probability density function (PDF) of the Normal distribution. Ref http://www.itl.nist.gov/div898/handbook/ 1.3.6.6.1
x | input statistic |
mu | mean of the sample (location parameter of the distribution) |
sig | std dev of the sample (scale parameter of the distribution) |
Exception | if math throws |
Definition at line 570 of file SpecialFuncs.cpp.
|
inline |
returns the column sum norm of the matrix
Definition at line 132 of file MatrixBaseOperators.hpp.
|
inline |
returns the frobenius norm or RSS of the matrix
Definition at line 118 of file MatrixBaseOperators.hpp.
Same as upEastNorth(), but with rows re-ordered.
Given a Position, compute unit vectors in ECEF coordinates in the North, East and Up directions at that position. Use either geodetic coordinates, i.e. so that 'up' is perpendicular to the geoid, not from center of Earth; or geocentric coordinates, so that the vertical meets the center of the Earth. Return the vectors in the form of a 3x3 Matrix<double>. This is in fact the rotation matrix that will take an ECEF (XYZ) vector into North,East,Up. Individual unit vectors can be defined from this rotation matrix R by
[in] | pos | Position at which the rotation matrix will be defined. |
[in] | geoc | If true, use geocentric, else geodetic coordinates (default false). |
Exception |
rad N
rad E
Definition at line 57 of file SunEarthSatGeometry.cpp.
Same as northEastUp(pos, true).
Same as northEastUp(pos, true).
[in] | pos | Position at which the rotation matrix will be defined. |
Exception |
Definition at line 97 of file SunEarthSatGeometry.cpp.
Same as northEastUp(pos, false).
Same as northEastUp(pos, false).
[in] | pos | Position at which the rotation matrix will be defined. |
Exception |
Definition at line 101 of file SunEarthSatGeometry.cpp.
|
inline |
operator != for IonexData::IonexValType
Definition at line 259 of file IonexData.hpp.
Definition at line 318 of file Namelist.cpp.
Definition at line 357 of file Namelist.cpp.
|
inline |
Returns the top to bottom concatenation of Matrix t and Vector b only if they have the same number of columns.
MatrixException |
Definition at line 92 of file MatrixOperators.hpp.
|
inline |
Returns the top to bottom concatenation of Vector t and Matrix b only if they have the same number of columns.
MatrixException |
Definition at line 121 of file MatrixOperators.hpp.
|
inline |
Multiplies all the elements of m by d.
Definition at line 970 of file MatrixOperators.hpp.
|
inline |
Matrix * Matrix : row by column multiplication of two matricies.
MatrixException |
Definition at line 814 of file MatrixOperators.hpp.
|
inline |
Matrix times vector multiplication, returning a vector.
MatrixException |
Definition at line 838 of file MatrixOperators.hpp.
|
inline |
Vector times matrix multiplication, returning a vector.
MatrixException |
Definition at line 862 of file MatrixOperators.hpp.
SparseMatrix< T > gnsstk::operator* | ( | const Matrix< T > & | L, |
const SparseMatrix< T > & | R | ||
) |
Matrix multiply: SparseMatrix = Matrix * SparseMatrix.
Definition at line 1270 of file SparseMatrix.hpp.
SparseVector< T > gnsstk::operator* | ( | const Matrix< T > & | L, |
const SparseVector< T > & | V | ||
) |
Matrix,Vector multiply: SparseVector = Matrix * SparseVector.
Definition at line 1023 of file SparseMatrix.hpp.
SparseMatrix< T > gnsstk::operator* | ( | const SparseMatrix< T > & | L, |
const Matrix< T > & | R | ||
) |
Matrix multiply: SparseMatrix = SparseMatrix * Matrix.
Definition at line 1225 of file SparseMatrix.hpp.
SparseMatrix< T > gnsstk::operator* | ( | const SparseMatrix< T > & | L, |
const SparseMatrix< T > & | R | ||
) |
Matrix multiply: SparseMatrix = SparseMatrix * SparseMatrix.
Definition at line 1186 of file SparseMatrix.hpp.
SparseVector< T > gnsstk::operator* | ( | const SparseMatrix< T > & | L, |
const SparseVector< T > & | V | ||
) |
Matrix,Vector multiply: SparseVector = SparseMatrix * SparseVector.
Definition at line 996 of file SparseMatrix.hpp.
SparseVector< T > gnsstk::operator* | ( | const SparseMatrix< T > & | L, |
const Vector< T > & | V | ||
) |
Matrix,Vector multiply: SparseVector = SparseMatrix * Vector.
Definition at line 1056 of file SparseMatrix.hpp.
SparseVector< T > gnsstk::operator* | ( | const SparseVector< T > & | V, |
const Matrix< T > & | R | ||
) |
Vector,Matrix multiply: SparseVector = SparseVector * Matrix.
Definition at line 1119 of file SparseMatrix.hpp.
SparseVector< T > gnsstk::operator* | ( | const SparseVector< T > & | V, |
const SparseMatrix< T > & | R | ||
) |
Vector,Matrix multiply: SparseVector = SparseVector * SparseMatrix.
Definition at line 1083 of file SparseMatrix.hpp.
|
inline |
Multiplies all the elements of m by d.
Definition at line 978 of file MatrixOperators.hpp.
SparseVector< T > gnsstk::operator* | ( | const Vector< T > & | V, |
const SparseMatrix< T > & | R | ||
) |
Vector,Matrix multiply: SparseVector = Vector * SparseMatrix.
Definition at line 1153 of file SparseMatrix.hpp.
Multiplication Operator.
Definition at line 318 of file Triple.cpp.
|
inline |
Adds all the elements of m by d.
Definition at line 1002 of file MatrixOperators.hpp.
|
inline |
Compute sum of two matricies.
MatrixException |
Definition at line 887 of file MatrixOperators.hpp.
SparseMatrix< T > gnsstk::operator+ | ( | const Matrix< T > & | L, |
const SparseMatrix< T > & | R | ||
) |
Matrix addition: SparseMatrix = Matrix + SparseMatrix : copy, += M in rev order
Definition at line 1643 of file SparseMatrix.hpp.
Add two Positions, returning result as a Position in Cartesian coordinates, the only system in which a position sum makes sense.
right | Position to add to this one. |
Definition at line 204 of file Position.cpp.
SparseMatrix< T > gnsstk::operator+ | ( | const SparseMatrix< T > & | L, |
const Matrix< T > & | R | ||
) |
Matrix addition: SparseMatrix = SparseMatrix + Matrix : copy, += M.
Definition at line 1624 of file SparseMatrix.hpp.
SparseMatrix< T > gnsstk::operator+ | ( | const SparseMatrix< T > & | L, |
const SparseMatrix< T > & | R | ||
) |
Matrix addition: SparseMatrix = SparseMatrix + SparseMatrix : copy, += SM.
Definition at line 1608 of file SparseMatrix.hpp.
SparseVector< T > gnsstk::operator+ | ( | const SparseVector< T > & | L, |
const SparseVector< T > & | R | ||
) |
Definition at line 1182 of file SparseVector.hpp.
SparseVector< T > gnsstk::operator+ | ( | const SparseVector< T > & | L, |
const Vector< T > & | R | ||
) |
Definition at line 1198 of file SparseVector.hpp.
merge two SRIs to produce a third. ? should this be operator&() ?
MatrixException | |
VectorException |
|
inline |
Adds all the elements of m by d.
Definition at line 1010 of file MatrixOperators.hpp.
SparseVector< T > gnsstk::operator+ | ( | const Vector< T > & | L, |
const SparseVector< T > & | R | ||
) |
Definition at line 1214 of file SparseVector.hpp.
FileSpec::FileSpecType & gnsstk::operator++ | ( | FileSpec::FileSpecType & | fst, |
int | |||
) |
Operator++ for FileSpecType.
Definition at line 64 of file FileSpec.cpp.
|
inline |
Subtracts all the elements of m by d.
Definition at line 1018 of file MatrixOperators.hpp.
|
inline |
Compute difference of two matricies.
MatrixException |
Definition at line 910 of file MatrixOperators.hpp.
SparseMatrix< T > gnsstk::operator- | ( | const Matrix< T > & | L, |
const SparseMatrix< T > & | R | ||
) |
Matrix subtraction: SparseMatrix = Matrix - SparseMatrix.
Definition at line 1483 of file SparseMatrix.hpp.
Difference two Positions, returning result as a Position in Cartesian coordinates, the only system in which a position difference makes sense.
right | Position to subtract from this one. |
Definition at line 190 of file Position.cpp.
SparseMatrix< T > gnsstk::operator- | ( | const SparseMatrix< T > & | L, |
const Matrix< T > & | R | ||
) |
Matrix subtraction: SparseMatrix = SparseMatrix - Matrix.
Definition at line 1467 of file SparseMatrix.hpp.
SparseMatrix< T > gnsstk::operator- | ( | const SparseMatrix< T > & | L, |
const SparseMatrix< T > & | R | ||
) |
Matrix subtraction: SparseMatrix = SparseMatrix - SparseMatrix.
Definition at line 1451 of file SparseMatrix.hpp.
SparseVector< T > gnsstk::operator- | ( | const SparseVector< T > & | L, |
const SparseVector< T > & | R | ||
) |
Definition at line 1133 of file SparseVector.hpp.
SparseVector< T > gnsstk::operator- | ( | const SparseVector< T > & | L, |
const Vector< T > & | R | ||
) |
Definition at line 1149 of file SparseVector.hpp.
|
inline |
Subtracts all the elements of m by d.
Definition at line 1026 of file MatrixOperators.hpp.
SparseVector< T > gnsstk::operator- | ( | const Vector< T > & | L, |
const SparseVector< T > & | R | ||
) |
Definition at line 1165 of file SparseVector.hpp.
FileSpec::FileSpecType & gnsstk::operator-- | ( | FileSpec::FileSpecType & | fst, |
int | |||
) |
Operator– for FileSpecType.
Definition at line 57 of file FileSpec.cpp.
|
inline |
Divides all the elements of m by d.
Definition at line 986 of file MatrixOperators.hpp.
|
inline |
Divides all the elements of m by d.
Definition at line 994 of file MatrixOperators.hpp.
|
inline |
operator < for IonexData::IonexValType
Definition at line 265 of file IonexData.hpp.
|
inline |
operator < for RinexObsType
Definition at line 374 of file RinexObsHeader.hpp.
Our generic formatted output operator This function provides compatibility with the ostream_iterator class.
o | the stream to write to |
f | the data to write |
o
FFStreamError | |
StringUtils::StringException |
Definition at line 59 of file FFData.cpp.
ostream& gnsstk::operator<< | ( | ostream & | os, |
const EarthOrientation & | eo | ||
) |
Definition at line 86 of file EarthOrientation.cpp.
ostream& gnsstk::operator<< | ( | ostream & | os, |
const EOPPrediction & | eopp | ||
) |
Definition at line 295 of file EOPPrediction.cpp.
Definition at line 48 of file format.cpp.
ostream& gnsstk::operator<< | ( | ostream & | os, |
const LabeledVector & | LV | ||
) |
Definition at line 570 of file Namelist.cpp.
Definition at line 550 of file Namelist.cpp.
ostream& gnsstk::operator<< | ( | ostream & | os, |
const SRIleastSquares & | srif | ||
) |
Definition at line 601 of file SRIleastSquares.cpp.
ostream& gnsstk::operator<< | ( | ostream & | os, |
const TimeSystem | ts | ||
) |
Definition at line 48 of file TimeSystem.cpp.
ostream& gnsstk::operator<< | ( | ostream & | os, |
const WtdAveStats & | was | ||
) |
Definition at line 60 of file PRSolution.cpp.
ostream& gnsstk::operator<< | ( | ostream & | s, |
CarrierBand | cb | ||
) |
Definition at line 48 of file RinexObsID_T.cpp.
ostream& gnsstk::operator<< | ( | ostream & | s, |
const BrcClockCorrection & | eph | ||
) |
Definition at line 451 of file BrcClockCorrection.cpp.
ostream& gnsstk::operator<< | ( | ostream & | s, |
const BrcKeplerOrbit & | eph | ||
) |
Definition at line 873 of file BrcKeplerOrbit.cpp.
ostream& gnsstk::operator<< | ( | ostream & | s, |
const EngEphemeris & | eph | ||
) |
Definition at line 1635 of file EngEphemeris.cpp.
Definition at line 200 of file Exception.cpp.
ostream& gnsstk::operator<< | ( | ostream & | s, |
const ExceptionLocation & | e | ||
) |
Definition at line 207 of file Exception.cpp.
ostream& gnsstk::operator<< | ( | ostream & | s, |
const gnsstk::SatelliteSystem | sys | ||
) |
Definition at line 48 of file SatMetaDataStore_T.cpp.
ostream& gnsstk::operator<< | ( | ostream & | s, |
const PackedNavBits & | pnb | ||
) |
Definition at line 1223 of file PackedNavBits.cpp.
Definition at line 1252 of file Position.cpp.
ostream& gnsstk::operator<< | ( | ostream & | s, |
GLOCOrbitType | e | ||
) |
Definition at line 89 of file PNBGLOCNavDataFactory_T.cpp.
ostream& gnsstk::operator<< | ( | ostream & | s, |
GLOCRegime | e | ||
) |
Definition at line 84 of file PNBGLOCNavDataFactory_T.cpp.
ostream& gnsstk::operator<< | ( | ostream & | s, |
GLOCSatType | e | ||
) |
Definition at line 79 of file PNBGLOCNavDataFactory_T.cpp.
ostream& gnsstk::operator<< | ( | ostream & | s, |
GLOFNavPCode | e | ||
) |
Definition at line 74 of file PNBGLOFNavDataFactory_T.cpp.
ostream& gnsstk::operator<< | ( | ostream & | s, |
GLOFNavSatType | e | ||
) |
Definition at line 69 of file PNBGLOFNavDataFactory_T.cpp.
ostream& gnsstk::operator<< | ( | ostream & | s, |
GPSLNavL2Codes | e | ||
) |
Definition at line 58 of file PNBGPSLNavDataFactory_T.cpp.
ostream& gnsstk::operator<< | ( | ostream & | s, |
ObservationType | ot | ||
) |
Definition at line 58 of file RinexObsID_T.cpp.
ostream & gnsstk::operator<< | ( | ostream & | s, |
SVHealth | h | ||
) |
Definition at line 74 of file PNBGLOCNavDataFactory_T.cpp.
ostream& gnsstk::operator<< | ( | ostream & | s, |
TrackingCode | tc | ||
) |
Definition at line 53 of file RinexObsID_T.cpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | o, |
const CommonTime & | ct | ||
) |
Definition at line 509 of file CommonTime.cpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | os, |
const LabeledMatrix & | LM | ||
) |
output ostream operator for LabeledMatrix
Definition at line 637 of file Namelist.cpp.
std::ostream& gnsstk::operator<< | ( | std::ostream & | os, |
const LabeledVector & | lv | ||
) |
output ostream operator for LabeledVector
std::ostream & gnsstk::operator<< | ( | std::ostream & | os, |
const SparseMatrix< T > & | SM | ||
) |
stream output operator
Definition at line 952 of file SparseMatrix.hpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | os, |
const SparseVector< T > & | SV | ||
) |
Definition at line 675 of file SparseVector.hpp.
std::ostream& gnsstk::operator<< | ( | std::ostream & | os, |
const TimeSystem | ts | ||
) |
Write name (asString()) of a TimeSystem to an output stream.
[in,out] | os | The output stream |
[in] | ts | The TimeSystem to be written |
|
noexcept |
|
inline |
Write name (asString()) of a Convention to an output stream.
[in,out] | os | The output stream |
[in] | cv | The Convention to be written |
Definition at line 90 of file IERSConvention.hpp.
|
inline |
Write name (asString()) of a ReferenceFrame to an output stream.
[in,out] | os | the output stream |
[in] | f | the ReferenceFrame to be written |
Definition at line 97 of file ReferenceFrame.hpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | os, |
gnsstk::SatPass & | sp | ||
) |
Stream output for SatPass.
os | output stream to write to |
sp | SatPass to write |
Definition at line 1378 of file SatPass.cpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
gnsstk::CarrierBand | e | ||
) |
Definition at line 56 of file ObsID_T.cpp.
std::ostream& gnsstk::operator<< | ( | std::ostream & | s, |
const AllanDeviation & | a | ||
) |
Definition at line 116 of file AllanDeviation.hpp.
Definition at line 278 of file AlmOrbit.cpp.
|
inline |
Definition at line 110 of file AngleReduced.hpp.
std::ostream& gnsstk::operator<< | ( | std::ostream & | s, |
const BivarStats< T > & | BVS | ||
) |
Output operator for BivarStats class.
Definition at line 150 of file BivarStats.hpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
const CNavFilterData & | nfd | ||
) |
Definition at line 78 of file CNavFilterData.cpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
const EngAlmanac & | alm | ||
) |
Definition at line 548 of file EngAlmanac.cpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
const FormattedDouble & | d | ||
) |
Stream output for FormattedDouble.
Definition at line 104 of file FormattedDouble.cpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
const gnsstk::GPSZcount & | z | ||
) |
Stream output operator for GPSZcount objects.
s
. Definition at line 381 of file GPSZcount.cpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
const gnsstk::NavMessageTypeSet & | nmts | ||
) |
Definition at line 86 of file MultiFormatNavDataFactory_T.cpp.
std::ostream& gnsstk::operator<< | ( | std::ostream & | s, |
const gnsstk::Triple & | v | ||
) |
Output operator for dvec
s | output stream to which v is sent |
v | dvec that is sent to s |
Definition at line 325 of file Triple.cpp.
|
noexcept |
Friendly Output Operator.
s | the output stream to which data is sent |
obs | the WxObservation from which the data comes |
Definition at line 232 of file WxObsMap.cpp.
stream output for GSatID
Definition at line 311 of file GSatID.hpp.
|
inline |
operator << for IonexData::IonexValType
Definition at line 271 of file IonexData.hpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
const LNavFilterData & | nfd | ||
) |
Definition at line 64 of file LNavFilterData.cpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
const NavFilterKey & | nfk | ||
) |
Definition at line 66 of file NavFilterKey.cpp.
|
inline |
Definition at line 103 of file NavMessageID.hpp.
|
inline |
Definition at line 176 of file NavSatelliteID.hpp.
|
inline |
Definition at line 110 of file NavSignalID.hpp.
Definition at line 54 of file ObsEpochMap.cpp.
Definition at line 284 of file ObsRngDev.cpp.
std::ostream& gnsstk::operator<< | ( | std::ostream & | s, |
const PackedNavBits & | pnb | ||
) |
Stream output operator for RefFrame, obviously.
[in,out] | s | The stream to write to. |
[in] | rf | The RefFrame object to write. |
Definition at line 124 of file RefFrame.hpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
const Rinex3ObsHeader::Fields & | v | ||
) |
Definition at line 2844 of file Rinex3ObsHeader.cpp.
|
inline |
operator << for RinexObsType
Definition at line 378 of file RinexObsHeader.hpp.
|
inline |
Stream output for RinexSatID.
Definition at line 143 of file RinexSatID.hpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
const SatelliteSystem | sys | ||
) |
Definition at line 50 of file SatID_T.cpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
const SatMetaData & | smd | ||
) |
Stream output for SatMetaData
Definition at line 141 of file SatMetaData.cpp.
|
inline |
Definition at line 503 of file SatMetaDataStore.hpp.
|
inline |
Definition at line 495 of file SatMetaDataStore.hpp.
stream output for SP3SatID
Definition at line 162 of file SP3SatID.hpp.
|
noexcept |
Definition at line 48 of file SvObsEpoch.cpp.
std::ostream& gnsstk::operator<< | ( | std::ostream & | s, |
const Transformer & | t | ||
) |
Definition at line 47 of file TransformLibrary_T.cpp.
std::ostream& gnsstk::operator<< | ( | std::ostream & | s, |
const TwoSampleStats< T > & | TSS | ||
) |
Output operator for TwoSampleStats class.
|
noexcept |
Definition at line 120 of file ValidType.hpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
gnsstk::CorrectorType | e | ||
) |
Definition at line 47 of file BCIonoCorrector_T.cpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
GLOFNavPCode | e | ||
) |
Definition at line 47 of file GLOFNavEph_T.cpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
GLOFNavSatType | e | ||
) |
Definition at line 44 of file GLOFNavData_T.cpp.
std::ostream& gnsstk::operator<< | ( | std::ostream & | s, |
gnsstk::AngleType | e | ||
) |
Definition at line 44 of file AngleType_T.cpp.
std::ostream& gnsstk::operator<< | ( | std::ostream & | s, |
gnsstk::CorrDupHandling | e | ||
) |
Definition at line 44 of file CorrDupHandling_T.cpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
gnsstk::GalDataValid | e | ||
) |
Definition at line 44 of file GalDataValid_T.cpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
gnsstk::GalHealthStatus | e | ||
) |
Definition at line 52 of file GalFNavAlm_T.cpp.
std::ostream& gnsstk::operator<< | ( | std::ostream & | s, |
gnsstk::GLOCOrbitType | e | ||
) |
Definition at line 61 of file GLOCNavAlm_T.cpp.
std::ostream& gnsstk::operator<< | ( | std::ostream & | s, |
gnsstk::GLOCRegime | e | ||
) |
Definition at line 65 of file GLOCNavEph_T.cpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
gnsstk::GLOCSatType | e | ||
) |
Definition at line 56 of file GLOCNavAlm_T.cpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
gnsstk::GPSLNavL2Codes | e | ||
) |
Definition at line 51 of file GPSLNavEph_T.cpp.
std::ostream& gnsstk::operator<< | ( | std::ostream & | s, |
gnsstk::IonexStoreStrategy | e | ||
) |
Definition at line 44 of file IonexStoreStrategy_T.cpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
gnsstk::NavMessageType | e | ||
) |
Definition at line 46 of file BDSD1NavAlm_T.cpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
gnsstk::NavType | e | ||
) |
Definition at line 55 of file NavID_T.cpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
gnsstk::NavValidityType | e | ||
) |
Definition at line 50 of file MultiFormatNavDataFactory_T.cpp.
std::ostream& gnsstk::operator<< | ( | std::ostream & | s, |
gnsstk::ObservationType | e | ||
) |
Definition at line 51 of file ObsID_T.cpp.
std::ostream& gnsstk::operator<< | ( | std::ostream & | s, |
gnsstk::RefFrameRlz | e | ||
) |
Definition at line 47 of file RefFrameRlz_T.cpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
gnsstk::RefFrameSys | e | ||
) |
Definition at line 52 of file RefFrameRlz_T.cpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
gnsstk::SVHealth | e | ||
) |
Definition at line 50 of file BDSD1NavHealth_T.cpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
gnsstk::TrackingCode | e | ||
) |
Definition at line 61 of file ObsID_T.cpp.
|
inline |
Definition at line 121 of file SatMetaData.hpp.
|
inline |
Definition at line 115 of file SatMetaData.hpp.
std::ostream & gnsstk::operator<< | ( | std::ostream & | s, |
gnsstk::XmitAnt | e | ||
) |
Definition at line 56 of file Rinex3Obs_T.cpp.
|
inline |
operator == for IonexData::IonexValType
Definition at line 253 of file IonexData.hpp.
Definition at line 282 of file Namelist.cpp.
|
inline |
operator == for RinexObsType
Definition at line 370 of file RinexObsHeader.hpp.
Generic formatted input operator. This should throw the same exceptions as FFData::getRecord(). Please read that for more info.
f | formatted file data record. |
i | the stream to read from |
FFStreamError | if the file being read is formatted incorrectly or some other file error occurs |
StringUtils::StringException | when StringUtils messes up. |
i
. This function provides compatibility with the istream_iterator class. Definition at line 65 of file FFData.cpp.
std::istream & gnsstk::operator>> | ( | std::istream & | s, |
FormattedDouble & | d | ||
) |
Stream input for FormattedDouble.
Definition at line 113 of file FormattedDouble.cpp.
Definition at line 387 of file Namelist.cpp.
Definition at line 372 of file Namelist.cpp.
|
inline |
Returns the left to right concatenation of l and r only if they have the same number of rows.
MatrixException |
Definition at line 150 of file MatrixOperators.hpp.
|
inline |
Returns the left to right concatenation of Matrix l and Vector r only if they have the same number of rows.
MatrixException |
Definition at line 180 of file MatrixOperators.hpp.
|
inline |
Returns the left to right concatenation of Vector l and Matrix r only if they have the same number of rows.
MatrixException |
Definition at line 209 of file MatrixOperators.hpp.
|
inline |
Returns the left to right concatenation of Vector l and Vector r only if they have the same number of rows.
MatrixException |
Definition at line 238 of file MatrixOperators.hpp.
SparseMatrix< T > gnsstk::operator|| | ( | const SparseMatrix< T > & | L, |
const SparseMatrix< T > & | R | ||
) |
Definition at line 1343 of file SparseMatrix.hpp.
SparseMatrix< T > gnsstk::operator|| | ( | const SparseMatrix< T > & | L, |
const Vector< T > & | V | ||
) |
Concatenation SparseMatrix || Vector TD the rest of them...
Definition at line 1313 of file SparseMatrix.hpp.
Compute the satellite attitude, given its position pos and velocity vel, assuming an orbit-normal attitude. Return a 3x3 Matrix which contains, as rows, the unit (ECEF) vectors X,Y,Z in the satellite body frame.
Compute the satellite attitude, given the satellite position pos and velocity vel, assuming an orbit-normal attitude. Return a 3x3 Matrix which contains, as rows, the unit (ECEF) vectors X,Y,Z in the body frame of the satellite, namely Z = along the boresight (i.e. towards Earth center), Y = perpendicular to orbital plane, pointing opposite the angular momentum vector, X = along-track (same direction as velocity vector for circular orbit). Thus this rotation matrix R transforms an ECEF XYZ vector into the body frame of the satellite, so R * (ECEF XYZ vector) = components in body frame. Also, R.transpose() * (sat. body. frame vector) = ECEF XYZ components.
[in] | pos | Satellite position. |
[in] | vel | Satellite velocity. |
Exception |
reverse and normalize Y
Definition at line 330 of file SunEarthSatGeometry.cpp.
|
inline |
Compute the outer product of two vectors.
MatrixException |
Definition at line 933 of file MatrixOperators.hpp.
std::string gnsstk::printAs | ( | const CommonTime & | t, |
const std::string & | fmt | ||
) |
This function converts the given CommonTime into the templatized TimeTag object, before calling the TimeTag's printf(fmt). If there's an error in conversion, it instead calls printf(fmt, true) to signal a conversion error.
Definition at line 135 of file TimeString.hpp.
void gnsstk::QSort | ( | T * | sa, |
int | na, | ||
int(*)(const T &, const T &) | comp = gnsstk::Qsort_compare |
||
) |
Quick sort in memory, with insert sort for small arrays. operator>() and operator<() must be defined for T, and a user comparison function comp(T,T) may be passed to override the default Qsort_compare().
sa | is the array of type T to be sorted. |
na | length of the array to be sorted. |
comp | (optional) the comparison function to be used. |
Definition at line 139 of file RobustStats.hpp.
void gnsstk::QSort | ( | T * | sa, |
S * | pa, | ||
int | na, | ||
int(*)(const T &, const T &) | comp = gnsstk::Qsort_compare |
||
) |
Quick sort of one vector, keeping another parallel. See the single-vector version of QSort.
sa | is the array of type T to be sorted. |
pa | is the array of type S to be kept parallel to the first. |
na | length of the array to be sorted. |
comp | (optional) the comparison function to be used. |
Definition at line 229 of file RobustStats.hpp.
double gnsstk::Rand | ( | long | seed | ) |
Generate random numbers uniformly distributed from 0 to 1.
Definition at line 56 of file random.cpp.
double gnsstk::RandExpCor | ( | double | dt, |
double | sigma, | ||
double | T, | ||
double | xlast | ||
) |
Generate exponentially correlated random numbers, given sqrt variance sigma, time step dt, time constant T, and previous point xlast.
Definition at line 200 of file random.cpp.
double gnsstk::RandNorm | ( | double | sigma | ) |
Generate normally distributed random numbers, zero mean and sqrt of variance sigma. Uses Box-Muller and Rand().
Definition at line 126 of file random.cpp.
double gnsstk::RandomWalk | ( | double | dt, |
double | sigma, | ||
double | xlast | ||
) |
Generate a random walk sequence, given sqrt variance sigma, time step dt and previous point xlast.
Definition at line 192 of file random.cpp.
GeometryException |
Definition at line 1273 of file Position.cpp.
void gnsstk::reallyGetRecordVer2 | ( | Rinex3ObsStream & | strm, |
Rinex3ObsData & | rod | ||
) |
Definition at line 390 of file Rinex3ObsData.cpp.
void gnsstk::reallyPutRecordVer2 | ( | Rinex3ObsStream & | strm, |
const Rinex3ObsData & | rod | ||
) |
Definition at line 56 of file Rinex3ObsData.cpp.
int gnsstk::RegisterExtendedRinexObsType | ( | std::string | t, |
std::string | d = std::string("(undefined)") , |
||
std::string | u = std::string("undefined") , |
||
unsigned int | dep = 0 |
||
) |
Function to allow user to define a new RINEX observation type.
int gnsstk::RegisterExtendedRinexObsType | ( | string | t, |
string | d, | ||
string | u, | ||
unsigned int | dep | ||
) |
Definition at line 969 of file RinexObsHeader.cpp.
Compute relativity correction (sec.s) from the satellite position and velocity
Definition at line 218 of file EphemerisRange.cpp.
void gnsstk::removeMilliseconds | ( | std::vector< SatPass > & | SPList, |
msecHandler & | msh | ||
) |
remove millisecond adjusts of the time tags and pseudoranges (C1 C2 P1 P2) and phases (L1 L2), given handler passed to earlier call to FindMilliseconds(). User the handler to print messages, etc.
SPList | input SatPass list for modification |
msh | message returned from FindMilliseconds() |
Exception |
void gnsstk::removeMilliseconds | ( | vector< SatPass > & | SPList, |
msecHandler & | msh | ||
) |
Definition at line 190 of file SatPassUtilities.cpp.
T gnsstk::RMS | ( | const ConstVectorBase< T, BaseClass > & | l | ) |
returns the root-mean-square of the elements of l
Definition at line 197 of file VectorOperators.hpp.
|
inline |
Return a rotation matrix [dimensioned 3x3, inverse() = transpose()] for the rotation through angle
radians about axis
number (= 1, 2 or 3).
MatrixException |
Definition at line 495 of file MatrixOperators.hpp.
|
inline |
Definition at line 277 of file MiscMath.hpp.
T gnsstk::RSS | ( | const ConstVectorBase< T, BaseClass > & | l | ) |
returns the root-sum-square of the elements of l
Definition at line 192 of file VectorOperators.hpp.
T gnsstk::RSS | ( | T | aa, |
T | bb | ||
) |
Perform the root sum square of aa, bb.
Definition at line 257 of file MiscMath.hpp.
T gnsstk::RSS | ( | T | aa, |
T | bb, | ||
T | cc | ||
) |
Perform the root sum square of aa, bb and cc.
Definition at line 246 of file MiscMath.hpp.
T gnsstk::RSS | ( | T | aa, |
T | bb, | ||
T | cc, | ||
T | dd | ||
) |
Perform the root sum square of aa, bb, cc and dd.
Definition at line 264 of file MiscMath.hpp.
Compute the satellite attitude, given the time and position sv. Use either class SolarSystem (high accuracy) or module SolarPosition (low accuracy) to get the Sun position. Return a 3x3 Matrix that contains, as rows, the unit (ECEF) vectors X,Y,Z in the satellite body frame.
[in] | sat | Satellite position. |
[in] | sun | Sun position. |
Compute the satellite attitude, given the time, the satellite position pos, and a Sun position. Use either class SolarSystem (high accuracy) or module SolarPosition (low accuracy) to get the Sun position; however note that SolarSystem::SatelliteAttitude(tt, sv, shadow, sunSVangle) makes both calls. Return a 3x3 Matrix that contains, as rows, the unit (ECEF) vectors X,Y,Z in the body frame of the satellite, namely Z = along the boresight (i.e. towards Earth center), Y = perpendicular to both Z and the satellite-Sun direction, and X = completing the orthonormal triad. X will generally point toward the Sun. Thus this rotation matrix R transforms an ECEF XYZ vector into the body frame of the satellite, so R * (ECEF XYZ vector) = components in body frame. Also, transpose(R) * (sat. body. frame vector) = ECEF XYZ components. Also return the shadow factor, which is the fraction of the Sun's area not visible to satellite; thus sf == 1 means the satellite is in eclipse.
[in] | pos | Satellite position at tt. |
[in] | sun | Sun position at tt. |
Exception |
Definition at line 266 of file SunEarthSatGeometry.cpp.
Compute the angle from satellite to Earth to Sun; that is the angular separation of the satellite and the Sun, as seen from the center of Earth.
[in] | sat | Satellite position |
[in] | sun | Sun position |
Compute the angle from satellite to Earth to Sun; that is the angular separation of the satellite and the Sun, as seen from the center of Earth. This angle lies between zero and pi, and it reaches zero (pi) only when the Sun lies exactly in the orbit plane at noon (midnight). Use either class SolarSystem (high accuracy) or module SolarPosition (low accuracy) to get the Sun position. Return the angle in radians.
[in] | sv | Satellite position. |
[in] | sun | Sun position at tt. |
Exception |
Definition at line 426 of file SunEarthSatGeometry.cpp.
void gnsstk::satelliteNadirAzimuthAngles | ( | const Position & | sv, |
const Position & | rx, | ||
const Matrix< double > & | rot, | ||
double & | nadir, | ||
double & | azimuth | ||
) |
Compute the azimuth and nadir angle, in the satellite body frame, of receiver Position RX as seen at the satellite Position SV. The nadir angle is measured from the Z axis, which points to Earth center, and azimuth is measured from the X axis.
[in] | sv | Satellite position. |
[in] | rx | Receiver position. |
[in] | rot | Rotation matrix (3,3), output of satelliteAttitude. |
[out] | nadir | Nadir angle in degrees. |
[out] | azimuth | Azimuth angle in degrees. |
Compute the azimuth and nadir angle, in the satellite body frame, of receiver Position rx as seen at the satellite Position sv. The nadir angle is measured from the Z axis, which points to Earth center, and azimuth is measured from the X axis.
[in] | sv | Satellite position. |
[in] | rx | Receiver position. |
[in] | rot | Rotation matrix (3,3), output of satelliteAttitude. |
[out] | nadir | Nadir angle in degrees. |
[out] | azimuth | Azimuth angle in degrees. |
Exception | if rotation matrix has wrong dimensions. |
Definition at line 377 of file SunEarthSatGeometry.cpp.
double gnsstk::satelliteYawAngle | ( | const Position & | pos, |
const Position & | vel, | ||
const Position & | sun, | ||
const bool & | blkIIRF, | ||
double & | yawrate | ||
) |
Compute the nominal yaw angle of the satellite given the satellite position and velocity and the Sun position at the given time, plus a flag for GPS Block IIR and IIF satellites. Return the nominal yaw angle in radians, and the yaw rate in radians/second.
[in] | Position | pos Satellite position at time of interest. |
[in] | Position | vel Satellite velocity at time of interest (Cartesian, m/s). |
[in] | Position | sun Sun position at time of interest. |
[in] | bool | blkIIRF True if the satellite is GPS block IIR or IIF. |
[out] | double | yawrate Yaw rate in rad/s. |
Compute the nominal yaw angle of the satellite given the satellite position and velocity and the Sun position at the given time, plus a flag for GPS Block IIR and IIF satellites. Return the nominal yaw angle in radians, and the yaw rate in radians/second.
[in] | pos | Satellite position at time of interest. |
[in] | vel | Satellite velocity at time of interest (Cartesian, m/s). |
[in] | sun | Sun position at time of interest. |
[in] | blkIIRF | True if the satellite is GPS block IIR or IIF. |
[out] | yawrate | Return yaw rate in rad/second. |
Exception |
Definition at line 534 of file SunEarthSatGeometry.cpp.
int gnsstk::SatPassFromRinexFiles | ( | std::vector< std::string > & | filenames, |
std::vector< std::string > & | obstypes, | ||
double | dt, | ||
std::vector< SatPass > & | SPList, | ||
std::vector< RinexSatID > | exSats = std::vector< RinexSatID >() , |
||
bool | lenient = true , |
||
gnsstk::Epoch | beginTime = gnsstk::CommonTime::BEGINNING_OF_TIME , |
||
gnsstk::Epoch | endTime = gnsstk::CommonTime::END_OF_TIME |
||
) |
Read a set of RINEX observation files, filling a vector of SatPass objects. Create the SatPass objects using the input list of observation types and timestep. If there are no obs types given (vector obstypes has size 0), then use the obs types in the header of the first file read. The files are sorted on their begin time before processing, and the resulting list of SatPass objects is in time order. Data before the begin time, and after the end time, is ignored. The list of SatPass objects need not be empty on input; however if not empty, then the list must be consistent with the input timestep and obs type list, and it will be sorted to be in time order. If a file cannot be opened, or it is not RINEX observation, simply skip it. NB. ngood for this SPL reflects # epochs with ALL obstypes != 0
filenames | vector of input RINEX observation file names |
obstypes | vector of observation types to include in SatPass (may be empty: include all) |
dt | data interval of existing SPList and input files |
SPList | vector of SatPass objects to fill, need not be empty, but if not empty, must have consistent obs types and dt. |
exSats | vector of satellites to exclude |
lenient | if true (default), be lenient in reading the RINEX format |
beginTime | reject data before this time (BEGINNING_OF_TIME) |
endTime | reject data after this time (END_OF TIME) |
gnsstk::Exception | if there are exceptions while reading, if the data in the file is out of time order. |
int gnsstk::SatPassFromRinexFiles | ( | vector< string > & | filenames, |
vector< string > & | obstypes, | ||
double | dtin, | ||
vector< SatPass > & | SPList, | ||
vector< RinexSatID > | exSats, | ||
bool | lenient, | ||
Epoch | beginTime, | ||
Epoch | endTime | ||
) |
Definition at line 251 of file SatPassUtilities.cpp.
int gnsstk::SatPassToRinex2File | ( | const std::string & | filename, |
RinexObsHeader & | header, | ||
std::vector< SatPass > & | SPList | ||
) |
deprecated - use SatPassToRinex3File for both 3 and 2. Iterate over the input vector of SatPass objects (sorted to be in time order) and write them, with the given header, to a RINEX v.2 observation file of the given filename.
Exception |
int gnsstk::SatPassToRinex2File | ( | const string & | filename, |
RinexObsHeader & | header, | ||
vector< SatPass > & | SPList | ||
) |
Definition at line 645 of file SatPassUtilities.cpp.
int gnsstk::SatPassToRinex3File | ( | const std::string & | filename, |
const Rinex3ObsHeader & | header, | ||
const std::map< char, std::vector< std::string >> & | sysobs, | ||
std::vector< SatPass > & | SPList | ||
) |
Iterate over the input vector of SatPass objects (sorted to be in time order) and write them, with the given header, to a RINEX VER 3 observation file of the given filename.
filename | RINEX ver 3 file to be written |
header | RINEX header to write |
sysobs | map of system-char and vector of obs types (strings) |
SPList | vector of SatPass over which to iterate |
Exception |
int gnsstk::SatPassToRinex3File | ( | const string & | filename, |
const Rinex3ObsHeader & | headerIn, | ||
const map< char, vector< string >> & | sysobs, | ||
vector< SatPass > & | SPList | ||
) |
Definition at line 795 of file SatPassUtilities.cpp.
void gnsstk::scanTime | ( | CommonTime & | t, |
const std::string & | str, | ||
const std::string & | fmt | ||
) |
void gnsstk::scanTime | ( | CommonTime & | t, |
const string & | str, | ||
const string & | fmt | ||
) |
Definition at line 125 of file TimeString.cpp.
Fill the TimeTag object btime with time information found in string str formatted according to string fmt.
Fill the TimeTag object btime with time information found in string str formatted according to string fmt.
Definition at line 93 of file TimeString.cpp.
double gnsstk::seriesIncompGamma | ( | double | a, |
double | x | ||
) |
Incomplete gamma function P(a,x), evaluated using series representation. P(a,x) = (1/gamma(a)) integral (0 to x) { exp(-t) t^(a-1) dt }
a | first argument, a > 0 |
x | second argument, x >= 0 |
Exception | if input arguments have a <= 0 or x < 0 |
Definition at line 222 of file SpecialFuncs.cpp.
Compute the fraction of the Sun covered by Earth as seen from a satellite, given Sun and satellite positions. Cf. the other version of this function.
[in] | sv | Satellite position. |
[in] | sun | Sun position. |
Exception |
Definition at line 222 of file SunEarthSatGeometry.cpp.
double gnsstk::shadowFactor | ( | double | angRadEarth, |
double | angRadSun, | ||
double | angSeparation | ||
) |
Compute the fraction of the Sun covered by the earth as seen from a satellite, given the angular radii of both, and their angular separation.
Compute the fraction of the Sun covered by the earth as seen from a satellite, given the angular radii of both, and their angular separation. See code for more documentation, including derivations.
[in] | angRadEarth | Angular radius of the earth as seen at the satellite. |
[in] | angRadSun | Angular radius of the sun as seen at the satellite. |
[in] | angSeparation | Angular distance of the sun from the Earth. |
Exception |
Definition at line 185 of file SunEarthSatGeometry.cpp.
|
static |
Definition at line 377 of file BrcClockCorrection.cpp.
|
static |
Definition at line 780 of file BrcKeplerOrbit.cpp.
|
static |
Definition at line 1363 of file EngEphemeris.cpp.
|
inline |
Uses the sum of minor determinates to calculate the whole det. Slow for large matricies, but it works.
MatrixException |
Definition at line 153 of file MatrixBaseOperators.hpp.
Position gnsstk::solarPosition | ( | const CommonTime & | t, |
double & | AR | ||
) |
Compute the Position of the Sun in WGS84 ECEF coordinates. Ref. Astronomical Almanac pg C24, as presented on USNO web site; claimed accuracy is about 1 arcminute, when t is within 2 centuries of 2000.
t | Input epoch of interest |
AR | Output apparent angular radius of sun as seen at Earth (deg) |
Definition at line 96 of file SolarPosition.cpp.
double gnsstk::solarPositionShadowFactor | ( | double | Rearth, |
double | Rsun, | ||
double | dES | ||
) |
Compute the fraction of the area of the Sun covered by the Earth as seen from another body (e.g. satellite).
Rearth | Apparent angular radius of Earth. |
Rsun | Apparent angular radius of Sun. |
dES | Angular separation of Sun and Earth. |
Definition at line 218 of file SolarPosition.cpp.
std::string gnsstk::sortRinex3ObsFiles | ( | std::vector< std::string > & | files | ) |
Sort a vector of RINEX 3 obs file names on the time of the first observation as found in the header. Return the sorted list in the calling argument. Do not include files that are found not to be RINEX 3 obs files, or that have invalid headers.
files | vector<string> containing filenames, with path |
string gnsstk::sortRinex3ObsFiles | ( | vector< string > & | files | ) |
Definition at line 399 of file RinexUtilities.cpp.
std::string gnsstk::sortRinexObsFiles | ( | std::vector< std::string > & | files | ) |
Sort a vector of RINEX obs file names on the time of the first observation as found in the header. Return the sorted list in the calling argument. Do not include files that are found not to be RINEX obs files, or that have invalid headers.
files | vector<string> containing filenames, with path |
Exception |
string gnsstk::sortRinexObsFiles | ( | vector< string > & | files | ) |
Definition at line 347 of file RinexUtilities.cpp.
SparseMatrix< T > gnsstk::SparseHouseholder | ( | const SparseMatrix< T > & | A | ) |
Householder transformation of a matrix.
Exception |
Definition at line 2297 of file SparseMatrix.hpp.
void gnsstk::SrifMU | ( | Matrix< T > & | R, |
Vector< T > & | Z, | ||
const Matrix< T > & | H, | ||
Vector< T > & | D, | ||
unsigned int | M = 0 |
||
) |
Square root information filter (Srif) measurement update (MU). Use the Householder transformation to combine the information stored in the square root information (SRI) covariance matrix R and state Z with new information in the given partials matrix and data vector to produce an updated SRI {R,Z}. Measurement noise associated with the new information (H and D) is assumed to be white with unit covariance. If necessary, the data may be 'whitened' by multiplying H and D by the inverse of the lower triangular square root of the covariance matrix; that is, compute L = Cholesky(Measurement covariance) and let H = L*H, D = L*D.
R | Upper triangluar apriori SRI covariance matrix of dimension N |
Z | A priori SRI state vector of length N |
H | Partials matrix of dimension MxN, unchanged on output. |
D | Data vector of length M; on output contains the residuals of fit. |
M | If H and D have dimension M' > M, then call with M = data length; otherwise M = 0 (the default) and is ignored. |
MatrixException | if the input has inconsistent dimensions. |
Definition at line 449 of file SRIMatrix.hpp.
void gnsstk::SrifMU | ( | Matrix< T > & | R, |
Vector< T > & | Z, | ||
Matrix< T > & | A, | ||
unsigned int | M = 0 |
||
) |
Square root information measurement update, with new data in the form of a single matrix concatenation of H and D: A = H || D. See doc for the overloaded SrifMU().
MatrixException |
Definition at line 341 of file SRIMatrix.hpp.
void gnsstk::SrifMU | ( | Matrix< T > & | R, |
Vector< T > & | Z, | ||
SparseMatrix< T > & | A, | ||
const unsigned int | M | ||
) |
Exception | Square root information measurement update, with new data in the form of a single SparseMatrix concatenation of H and D: A = H || D. See doc for the overloaded SrifMU(). |
Definition at line 2467 of file SparseMatrix.hpp.
void gnsstk::SrifMU | ( | Matrix< T > & | R, |
Vector< T > & | Z, | ||
SparseMatrix< T > & | P, | ||
Vector< T > & | D, | ||
const unsigned int | M | ||
) |
Exception |
Definition at line 2627 of file SparseMatrix.hpp.
Compute the statistics for a list of numbers. This algorithm is written to be stable in computing the standard deviation for sequences of number with a large mean value. (i.e. it doesn't accumulate sum of the value squared.)
Definition at line 85 of file stl_helpers.hpp.
double gnsstk::StudentsCDF | ( | double | t, |
int | n | ||
) |
Cumulative Distribution Function CDF() for Student-t-distribution CDF. If X is a random variable following a normal distribution with mean zero and variance unity, and chisq is a random variable following an independent chi-square distribution with n degrees of freedom, then the distribution of the ratio X/sqrt(chisq/n) is called Student's t-distribution with n degrees of freedom. The probability that |X/sqrt(chisq/n)| will be less than a fixed constant t is StudentCDF(t,n); Ref http://www.itl.nist.gov/div898/handbook/ 1.3.6.6.4 Abramowitz and Stegun 26.7.1
t | input statistic value |
n | degrees of freedom of first sample, n > 0 |
Exception | if n <= 0 or math throws |
Definition at line 921 of file SpecialFuncs.cpp.
double gnsstk::StudentsPDF | ( | double | X, |
int | n | ||
) |
Probability density function (PDF) of the Student t distribution. The null hypotheses that test the true mean, mu, against the standard or assumed mean, mu0 are: H0: mu = mu0 H0: mu <= mu0 H0: mu >= mu0 The basic statistics for the test are the sample mean and the standard deviation. The form of the test statistic depends on whether the poulation standard deviation, sigma, is known or is estimated from the data at hand. The more typical case is where the standard deviation must be estimated from the data, and the test statistic is t = (Ybar - mu0/(s/SQRT(N)) where the sample mean is Ybar = (1/N)*SUM[i=1 to N]Y(i) and the sample standard deviation is s = SQRT{(1/(N-1))*SUM[i=1 to N][Y(i) - Ybar)**2} with N - 1 degrees of freedom. For a test at significance level (probability) alpha, where alpha is chosen to be small, typically .01, .05 or .10, the hypothesis associated with each case enumerated above is rejected if: |t| >= t(alpha/2,N-1) t >= t(alpha,N-1) t <= -t(alpha,N-1) where t(alpha/2,N-1) is the upper alpha/2 critical value (inverse CDF) from the t distribution with N-1 degrees of freedom.
X | input statistic |
n | input value for number of degrees of freedom, n > 0 |
Exception | if n <= 0 or math throws |
Definition at line 890 of file SpecialFuncs.cpp.
|
inline |
Returns the sum of the elements of the vector
Definition at line 84 of file VectorBaseOperators.hpp.
void gnsstk::sunOrbitAngles | ( | const Position & | pos, |
const Position & | vel, | ||
const Position & | sun, | ||
double & | beta, | ||
double & | phi | ||
) |
Compute the angle between the Sun and the satellite orbit plane. Return the angle in radians; domain +-pi/2 and with the sign of RxV. That is, the angle is positive if the Sun is out of the orbit plane in the direction of R cross V; then Sun "sees" the orbit motion as counter-clockwise. Also return, in phi, the angle, in the plane of the orbit, from midnight to the satellite; domain 0 to 2pi, increasing in the direction of Vel. Use either class SolarSystem (high accuracy) or module SolarPosition (lower accuracy) to get the Sun position.
[in] | Position | pos Satellite position at time of interest. |
[in] | Position | vel Satellite velocity at time of interest. |
[in] | Position | sun Sun position at time of interest. |
[out] | double | beta Angle sun to plane of satellite orbit (rad). |
[out] | double | phi Angle in orbit plane, midn to satellite (rad). |
Compute the angle between the Sun and the satellite orbit plane, given the satellite position and velocity and Sun position. Return the angle in radians; domain +-Pi/2 and with the sign of RxV. That is, the angle is positive if the Sun is out of the orbit plane in the direction of R cross V; then Sun "sees" the orbit motion as counter-clockwise. Also return phi, the angle, in the orbit plane, from midnight to the satellite; domain 0 to 2Pi, increasing in the direction of vel. Use either class SolarSystem (high accuracy) or module SolarPosition (lower accuracy) to get the Sun position.
[in] | pos | Satellite position at time of interest. |
[in] | vel | Satellite velocity at time of interest. |
[in] | sun | Sun position at time of interest. |
[out] | phi | Return angle in orbit plane, midnight to satellite (rad). |
[out] | beta | Return angle sun to plane of satellite orbit (rad). |
Exception |
Compute phi, angle in orbit plane between Sun and sat. Zero at midnight, increasing with satellite motion. w = sSun - u*sin(beta) lies in the orbit plane but ~points to Sun, but if beta==pi/2, u==sSun and w==zero, phi is indeterminate.
Definition at line 465 of file SunEarthSatGeometry.cpp.
long gnsstk::timeAdjust8BitWeekRollover | ( | long | toCorrectWeek, |
long & | refWeek | ||
) |
This function is the same as timeAdjustWeekRollover, except that it is designed for 8-bit weeks (e.g. WNa) as opposed to 10-bit weeks.
[in] | toCorrectWeek | The suspect week from data that might be off by 256 weeks. |
[in,out] | refWeek | The known full week that will be used as a reference. If this value is zero (the default), the local system clock will be consulted to obtain a reference week. |
Definition at line 77 of file TimeCorrection.cpp.
|
static |
Definition at line 352 of file BrcClockCorrection.cpp.
|
static |
Definition at line 755 of file BrcKeplerOrbit.cpp.
|
static |
Definition at line 1339 of file EngEphemeris.cpp.
gnsstk::Xvt::HealthStatus gnsstk::toXvtHealth | ( | SVHealth | e | ) |
Cast SVHealth to Xvt::HealthStatus.
Definition at line 43 of file SVHealth.cpp.
|
inline |
Returns the trace of the matrix
MatrixException |
Definition at line 100 of file MatrixBaseOperators.hpp.
SparseMatrix<T> gnsstk::transform | ( | const SparseMatrix< T > & | M, |
const SparseMatrix< T > & | C | ||
) |
Exception |
Vector< T > gnsstk::transformDiag | ( | const SparseMatrix< T > & | P, |
const Matrix< T > & | C | ||
) |
Compute diagonal of P*C*P^T, ie diagonal of transform of square Matrix C.
diag of P * C * PT
Exception |
Definition at line 1836 of file SparseMatrix.hpp.
|
inline |
Returns a matrix that is m
transposed.
Definition at line 330 of file MatrixOperators.hpp.
SparseMatrix< T > gnsstk::transpose | ( | const SparseMatrix< T > & | M | ) |
transpose
Definition at line 829 of file SparseMatrix.hpp.
SparseMatrix<T> gnsstk::transposeTimesMatrix | ( | const SparseMatrix< T > & | M | ) |
products MT*M, M*MT, M*C*MT etc MT * M
Exception |
std::string gnsstk::typeString | ( | ) |
Definition at line 238 of file TestUtil.hpp.
Compute UDU (upper-diagonal-upper) decomposition of a square positive definite matrix. Return the upper triangular matrix U and the diagonal as a Vector<T>. The decomposition is such that A = U*diag(D)*transpose(U).
A | Matrix<T> to be decomposed, must be square and positive definite |
D | Vector<T> output diagonal matrix stored as a Vector |
MatrixException | if input is not square, |
SingularMatrixException | if input is not positive definite |
Definition at line 917 of file SRIMatrix.hpp.
Given a Position, compute unit (ECEF) vectors in the topocentric Up, East, North directions at that position. Use geodetic coordinates, i.e. 'up' is perpendicular to the geoid. Return the vectors in the form of a 3x3 Matrix<double>, this is in fact the rotation matrix that will take an ECEF vector into a local topocentric or 'up-east-north' vector.
Given a Position, compute unit vectors in ECEF coordinates in the Up, East and North directions at that position. Use either geodetic coordinates, i.e. so that 'up' is perpendicular to the geoid, not from center of Earth; or geocentric coordinates, so that the vertical meets the center of the Earth. Return the vectors in the form of a 3x3 Matrix<double>. This is in fact the rotation matrix that will take an ECEF (XYZ) vector into 'up,east,north'. Individual unit vectors can be defined from this rotation matrix R by
[in] | pos | Position at which the rotation matrix will be defined. |
[in] | geoc | If true, use geocentric, else geodetic coordinates (default). |
Exception |
Definition at line 111 of file SunEarthSatGeometry.cpp.
Same as upEastNorth, but using geocentric coordinates, so that the Up direction will meet the center of Earth.
Same as upEastNorth, but using geocentric coordinates, so that the Up direction will meet the center of Earth.
pos | Position at which the rotation matrix will be defined. |
Exception |
Definition at line 130 of file SunEarthSatGeometry.cpp.
Same as upEastNorth, but using geodetic coordinates.
Same as UpEastNorth, but using geodetic coordinates.
[in] | pos | Position at which the rotation matrix will be defined. |
Exception |
Definition at line 134 of file SunEarthSatGeometry.cpp.
Matrix< T > gnsstk::upperCholesky | ( | const Matrix< T > & | A, |
const T | ztol = T(1.e-16) |
||
) |
Compute upper triangular square root of a symmetric positive definite matrix, the Cholesky decomposition; that is A = U*UT = U*transpose(U).
A | Matrix to be decomposed; symmetric and positive definite, unchanged |
MatrixException | if input Matrix is not square |
SingularMatrixException | if input Matrix is not positive definite |
Definition at line 546 of file SRIMatrix.hpp.
SparseMatrix< T > gnsstk::upperCholesky | ( | const SparseMatrix< T > & | A | ) |
Exception | Compute upper triangular square root of a symmetric positive definite matrix (Cholesky decomposition) Crout algorithm; that is A = transpose(U)*U. Note that this result will be equal to transpose(lowerCholesky(A)) == transpose(Ch.L from class Cholesky), NOT Ch.U; class Cholesky computes L,U where A = L*LT = U*UT [while A=UT*U here]. |
A | SparseMatrix to be decomposed; symmetric and positive definite, const |
Exception | if input SparseMatrix is not square |
Exception | if input SparseMatrix is not positive definite |
Definition at line 2262 of file SparseMatrix.hpp.
|
inlinenoexcept |
Definition at line 124 of file GPS_URA.hpp.
|
inline |
Definition at line 168 of file GPS_URA.hpp.
|
inline |
Definition at line 180 of file GPS_URA.hpp.
|
inlinenoexcept |
Definition at line 146 of file GPS_URA.hpp.
Compute the product of an upper triangular matrix and its transpose.
UT | upper triangular matrix |
MatrixException | if input is not square (assumed upper triangular also). |
Definition at line 725 of file SRIMatrix.hpp.
std::vector<T> gnsstk::vec_intersect | ( | const std::vector< T > & | v1, |
const std::vector< T > & | v2 | ||
) |
find the intersection of two vectors - elements common to both vectors NB STL algorithms require sorting
v1 | first vector to consider |
v2 | second vector to consider |
Definition at line 136 of file stl_helpers.hpp.
std::vector<T> gnsstk::vec_notintersect | ( | const std::vector< T > & | v1, |
const std::vector< T > & | v2 | ||
) |
find the union minus the intersection of two vectors, that is, elements that appear in either one of the two vectors but not both. NB STL algorithms require sorting
v1 | first vector to consider |
v2 | second vector to consider |
Definition at line 154 of file stl_helpers.hpp.
VecBaseNewBinaryOperator Vector Vector<T> Vector<T> VecBaseNewBinaryOperator Vector VecBaseNewBinaryOperator Vector Vector<bool> Vector<bool> gnsstk::VecBaseNewBinaryOperator | ( | ! | , |
Vector< bool > | |||
) |
VecBaseNewBinaryOperator Vector Vector<T> Vector<T> VecBaseNewBinaryOperator Vector VecBaseNewBinaryOperator Vector Vector<bool> gnsstk::VecBaseNewBinaryOperator | ( | ) |
VecBaseNewBinaryOperator Vector Vector<T> Vector<T> VecBaseNewBinaryOperator Vector VecBaseNewBinaryOperator Vector Vector<bool> Vector<bool> Vector<bool> gnsstk::VecBaseNewBinaryOperator | ( | >= | , |
Vector< bool > | |||
) |
finds the cross product between l and r
VectorException |
VecBaseNewBinaryOperator Vector Vector<T> Vector<T> VecBaseNewBinaryOperator Vector VecBaseNewBinaryOperator Vector gnsstk::VecBaseNewBinaryOperator | ( | | | , |
Vector< T > | |||
) |
gnsstk::VecShortwireComparisonOperator | ( | eq | ) |
find the index of the first element of a vector with a given value
vec | vector<T> in which to look for value |
value | T value to search for in vector |
Definition at line 123 of file stl_helpers.hpp.
bool gnsstk::willPrintAs | ( | const std::string & | fmt | ) |
This function determines if the given format includes items that would be printed by the TimeTag's printf(fmt); NB except 'P' (system). In other words, determine if printAs<T>(t,fmt) will not modify the string.
Definition at line 155 of file TimeString.hpp.
const double gnsstk::A_REF_GPS = 26559710.0 |
Reference Semi-major axis. From IS-GPS-800 Table 3.5-2 in meters.
Definition at line 106 of file GNSSconstants.hpp.
const NavMessageTypeSet gnsstk::allNavMessageTypes |
Convenient set of all valid (non-meta) message types.
Definition at line 64 of file NavStatic.cpp.
const double gnsstk::BDS_EPOCH_JD = 2453736.5 |
'Julian day' of BDS epoch (Jan. 1, 2006).
Definition at line 118 of file TimeConstants.hpp.
const long gnsstk::BDS_EPOCH_MJD = 53736L |
Modified Julian Date of BDS epoch (Jan. 1, 2006).
Definition at line 120 of file TimeConstants.hpp.
const long gnsstk::BDS_WEEK_PER_EPOCH = 8192L |
Weeks per BDS Epoch.
Definition at line 122 of file TimeConstants.hpp.
|
static |
Definition at line 57 of file IonexStore.cpp.
const double gnsstk::C_MPS = 2.99792458e8 |
m/s, speed of light; this value defined by GPS but applies to GAL and GLO.
Definition at line 74 of file GNSSconstants.hpp.
const double gnsstk::CA_CHIP_FREQ_GLO = OSC_FREQ_GLO / 10.0 |
GLO Chip rate of the C/A code in Hz.
Definition at line 184 of file GNSSconstants.hpp.
const double gnsstk::CA_CHIP_FREQ_GPS = OSC_FREQ_GPS / 10.0 |
Hz, GPS chip rate of the C/A code.
Definition at line 92 of file GNSSconstants.hpp.
|
static |
Define additional/other bits are the data requires.
Definition at line 86 of file DataStatus.hpp.
const double gnsstk::DAY_PER_MS = 1.0/MS_PER_DAY |
Days per milliseconds.
Definition at line 75 of file TimeConstants.hpp.
const double gnsstk::DAY_PER_SEC = 1.0/SEC_PER_DAY |
Days per second.
Definition at line 65 of file TimeConstants.hpp.
const double gnsstk::DAY_PER_ZCOUNT = 1.0/ZCOUNT_PER_DAY |
Days in a Zcount.
Definition at line 90 of file TimeConstants.hpp.
GNSSTK_EXPORT CommandOptionVec gnsstk::defaultCommandOptionList |
The default command option list used by CommandOption and gnsstk::CommandOptionParser
Definition at line 55 of file CommandOption.cpp.
Multiply degrees by DEG2RAD to get radians.
Definition at line 64 of file GNSSconstants.hpp.
|
static |
degrees per milliarcsecond (1e-3/3600.)
Definition at line 80 of file GNSSconstants.hpp.
|
static |
Conversion Factor from degrees to radians (units: degrees^-1)
Definition at line 76 of file GNSSconstants.hpp.
|
static |
Definition at line 87 of file DataStatus.hpp.
const double gnsstk::FREQ_BEIDOU_B1 = 1561.098e6 |
BeiDou B1 carrier frequency in Hz.
Definition at line 148 of file FreqConsts.hpp.
const double gnsstk::FREQ_BEIDOU_B1U = 1589.742e6 |
BeiDou B1U carrier frequency in Hz.
Definition at line 140 of file FreqConsts.hpp.
const double gnsstk::FREQ_BEIDOU_B2 = 1191.795e6 |
BeiDou B2 carrier frequency in Hz.
Definition at line 160 of file FreqConsts.hpp.
const double gnsstk::FREQ_BEIDOU_B2a = 1176.45e6 |
BeiDou B2a carrier frequency in Hz.
Definition at line 164 of file FreqConsts.hpp.
const double gnsstk::FREQ_BEIDOU_B2b = 1207.14e6 |
BeiDou B2b carrier frequency in Hz.
Definition at line 152 of file FreqConsts.hpp.
const double gnsstk::FREQ_BEIDOU_B3 = 1268.52e6 |
BeiDou B3 carrier frequency in Hz.
Definition at line 156 of file FreqConsts.hpp.
const double gnsstk::FREQ_BEIDOU_L1 = 1575.42e6 |
BeiDou L1 carrier frequency in Hz.
Definition at line 144 of file FreqConsts.hpp.
const double gnsstk::FREQ_GALILEO_E1 = 1575.42e6 |
Galileo E1 carrier frequency in Hz.
Definition at line 96 of file FreqConsts.hpp.
const double gnsstk::FREQ_GALILEO_E5 = 1191.795e6 |
Galileo E5 carrier frequency in Hz.
Definition at line 104 of file FreqConsts.hpp.
const double gnsstk::FREQ_GALILEO_E5a = 1176.45e6 |
Galileo E5a carrier frequency in Hz.
Definition at line 108 of file FreqConsts.hpp.
const double gnsstk::FREQ_GALILEO_E5b = 1207.14e6 |
Galileo E5b carrier frequency in Hz.
Definition at line 100 of file FreqConsts.hpp.
const double gnsstk::FREQ_GALILEO_E6 = 1278.75e6 |
Galileo E6 carrier frequency in Hz.
Definition at line 112 of file FreqConsts.hpp.
const double gnsstk::FREQ_GLONASS_G1 = 1602e6 |
GLONASS G1 carrier frequency in Hz.
Definition at line 68 of file FreqConsts.hpp.
const double gnsstk::FREQ_GLONASS_G1a = 1600.995e6 |
GLONASS G1a carrier frequency in Hz.
Definition at line 72 of file FreqConsts.hpp.
const double gnsstk::FREQ_GLONASS_G2 = 1246e6 |
GLONASS G2 carrier frequency in Hz.
Definition at line 80 of file FreqConsts.hpp.
const double gnsstk::FREQ_GLONASS_G2a = 1248.06e6 |
GLONASS G2a carrier frequency in Hz.
Definition at line 76 of file FreqConsts.hpp.
const double gnsstk::FREQ_GLONASS_G2c = 1242e6 |
GLONASS G2c carrier frequency in Hz.
Definition at line 84 of file FreqConsts.hpp.
const double gnsstk::FREQ_GLONASS_G3 = 1202.025e6 |
GLONASS G3 carrier frequency in Hz.
Definition at line 92 of file FreqConsts.hpp.
const double gnsstk::FREQ_GLONASS_G5 = 1207.14e6 |
GLONASS G5 carrier frequency in Hz.
Definition at line 88 of file FreqConsts.hpp.
const double gnsstk::FREQ_GPS_L1 = 1575.42e6 |
GPS L1 carrier frequency in Hz.
Definition at line 56 of file FreqConsts.hpp.
const double gnsstk::FREQ_GPS_L2 = 1227.6e6 |
GPS L2 carrier frequency in Hz.
Definition at line 60 of file FreqConsts.hpp.
const double gnsstk::FREQ_GPS_L5 = 1176.45e6 |
GPS L5 carrier frequency in Hz.
Definition at line 64 of file FreqConsts.hpp.
const double gnsstk::FREQ_NAVIC_L5 = 1176.45e6 |
NavIC L5 carrier frequency in Hz.
Definition at line 172 of file FreqConsts.hpp.
const double gnsstk::FREQ_NAVIC_S = 2492.028e6 |
NavIC S carrier frequency in Hz.
Definition at line 168 of file FreqConsts.hpp.
const double gnsstk::FREQ_QZSS_L1 = 1575.42e6 |
QZSS L1 carrier frequency in Hz.
Definition at line 124 of file FreqConsts.hpp.
const double gnsstk::FREQ_QZSS_L2 = 1227.6e6 |
QZSS L2 carrier frequency in Hz.
Definition at line 128 of file FreqConsts.hpp.
const double gnsstk::FREQ_QZSS_L5 = 1176.45e6 |
QZSS L5 carrier frequency in Hz.
Definition at line 132 of file FreqConsts.hpp.
const double gnsstk::FREQ_QZSS_L6 = 1278.75e6 |
QZSS L6 carrier frequency in Hz.
Definition at line 136 of file FreqConsts.hpp.
const double gnsstk::FREQ_SBAS_L1 = 1575.42e6 |
SBAS L1 carrier frequency in Hz.
Definition at line 116 of file FreqConsts.hpp.
const double gnsstk::FREQ_SBAS_L5 = 1176.45e6 |
SBAS L5 carrier frequency in Hz.
Definition at line 120 of file FreqConsts.hpp.
const double gnsstk::FREQ_STEP_GLONASS_G1 = 562.5e3 |
GLONASS G1 carrier frequency step size in Hz.
Definition at line 176 of file FreqConsts.hpp.
const double gnsstk::FREQ_STEP_GLONASS_G2 = 437.5e3 |
GLONASS G2 carrier frequency step size in Hz.
Definition at line 178 of file FreqConsts.hpp.
const long gnsstk::FULLWEEK = 604800L |
Seconds per whole week.
Definition at line 60 of file TimeConstants.hpp.
const double gnsstk::GAL_EPOCH_JD = 2451412.5 |
'Julian day' of GAL epoch (Aug 22 1999)
Definition at line 102 of file TimeConstants.hpp.
const long gnsstk::GAL_EPOCH_MJD = 51412L |
Modified Julian Date of GAL epoch (Aug 22 1999)
Definition at line 104 of file TimeConstants.hpp.
const long gnsstk::GAL_WEEK_PER_EPOCH = 4096L |
Weeks per GAL Epoch.
Definition at line 106 of file TimeConstants.hpp.
const double gnsstk::GAMMA_GPS = 1.646944444 |
Definition at line 104 of file GNSSconstants.hpp.
const double gnsstk::GAMMA_GPS_12 = (L1_MULT_GPS/L2_MULT_GPS) * (L1_MULT_GPS/L2_MULT_GPS) |
GPS Gamma constants.
Definition at line 102 of file GNSSconstants.hpp.
const double gnsstk::GAMMA_GPS_15 = (L1_MULT_GPS/L5_MULT_GPS) * (L1_MULT_GPS/L5_MULT_GPS) |
Definition at line 103 of file GNSSconstants.hpp.
|
static |
Definition at line 51 of file GGTropModel.cpp.
|
static |
Definition at line 52 of file GGTropModel.cpp.
const double gnsstk::GLO_EPOCH_JD = 2450082.5 |
'Julian day' of GLONASS epoch (Jan. 1, 1996).
Definition at line 134 of file TimeConstants.hpp.
const long gnsstk::GLO_EPOCH_MJD = 50083 |
Modified Julian Date of GLONASS epoch (Jan. 1, 1996).
Definition at line 136 of file TimeConstants.hpp.
|
static |
Definition at line 149 of file NavStatic.cpp.
const double gnsstk::GPS_EPOCH_JD = 2444244.5 |
'Julian day' of GPS epoch (Jan. 6, 1980).
Definition at line 81 of file TimeConstants.hpp.
const long gnsstk::GPS_EPOCH_MJD = 44244L |
Modified Julian Date of GPS epoch (Jan. 6, 1980).
Definition at line 83 of file TimeConstants.hpp.
const long gnsstk::GPS_WEEK_PER_EPOCH = 1024L |
Weeks per GPS Epoch.
Definition at line 85 of file TimeConstants.hpp.
const long gnsstk::HALFWEEK = 302400L |
Seconds per half week.
Definition at line 58 of file TimeConstants.hpp.
const double gnsstk::IRN_EPOCH_JD = 2451412.5 |
'Julian day' of IRN epoch (Aug 22, 1999).
Definition at line 126 of file TimeConstants.hpp.
const long gnsstk::IRN_EPOCH_MJD = 51412L |
Modified Julian Date of BDS epoch (Aug 22, 1999).
Definition at line 128 of file TimeConstants.hpp.
const long gnsstk::IRN_WEEK_PER_EPOCH = 1024L |
Weeks per BDS Epoch.
Definition at line 130 of file TimeConstants.hpp.
const double gnsstk::L1_FREQ_BDS = 1561.098e6 |
BDS L1 (B1) carrier frequency in Hz.
Definition at line 119 of file DeprecatedConsts.hpp.
const double gnsstk::L1_FREQ_GAL = L1_FREQ_GPS |
GAL L1 (E1) carrier frequency in Hz.
Definition at line 85 of file DeprecatedConsts.hpp.
const double gnsstk::L1_FREQ_GEO = L1_FREQ_GPS |
GEO L1 carrier frequency in Hz.
Definition at line 108 of file DeprecatedConsts.hpp.
const double gnsstk::L1_FREQ_GLO = 1602.0e6 |
GLO L1 carrier base frequency in Hz.
Definition at line 68 of file DeprecatedConsts.hpp.
const double gnsstk::L1_FREQ_GPS = 1575.42e6 |
GPS L1 carrier frequency in Hz.
Definition at line 51 of file DeprecatedConsts.hpp.
const double gnsstk::L1_FREQ_QZS = L1_FREQ_GPS |
QZS L1 carrier frequency in Hz.
Definition at line 134 of file DeprecatedConsts.hpp.
const double gnsstk::L1_FREQ_STEP_GLO = 562.5e3 |
GLO L1 carrier frequency step size in Hz.
Definition at line 70 of file DeprecatedConsts.hpp.
const double gnsstk::L1_MULT_GLO = 320.4 |
GLO L1 multiplier.
Definition at line 192 of file GNSSconstants.hpp.
const double gnsstk::L1_MULT_GPS = 154.0 |
GPS L1 frequency in units of oscillator frequency.
Definition at line 96 of file GNSSconstants.hpp.
const double gnsstk::L1_WAVELENGTH_BDS = 0.192039486310276 |
BDS L1 carrier wavelength in meters.
Definition at line 126 of file DeprecatedConsts.hpp.
const double gnsstk::L1_WAVELENGTH_GAL = L1_WAVELENGTH_GPS |
GAL L1 carrier wavelength in meters.
Definition at line 96 of file DeprecatedConsts.hpp.
const double gnsstk::L1_WAVELENGTH_GEO = L1_WAVELENGTH_GPS |
GEO L1 carrier wavelength in meters.
Definition at line 113 of file DeprecatedConsts.hpp.
const double gnsstk::L1_WAVELENGTH_GLO = 0.187136365793 |
GLO L1 carrier wavelength in meters.
Definition at line 72 of file DeprecatedConsts.hpp.
const double gnsstk::L1_WAVELENGTH_GPS = 0.190293672798 |
GPS L1 carrier wavelength in meters.
Definition at line 57 of file DeprecatedConsts.hpp.
const double gnsstk::L1_WAVELENGTH_QZS = L1_WAVELENGTH_GPS |
QZS L1 carrier wavelength in meters.
Definition at line 143 of file DeprecatedConsts.hpp.
const double gnsstk::L2_FREQ_BDS = L7_FREQ_GAL |
BDS L2 (B2) carrier frequency in Hz.
Definition at line 121 of file DeprecatedConsts.hpp.
const double gnsstk::L2_FREQ_GLO = 1246.0e6 |
GLO L2 carrier base frequency in Hz.
Definition at line 74 of file DeprecatedConsts.hpp.
const double gnsstk::L2_FREQ_GPS = 1227.60e6 |
GPS L2 carrier frequency in Hz.
Definition at line 53 of file DeprecatedConsts.hpp.
const double gnsstk::L2_FREQ_QZS = L2_FREQ_GPS |
QZS L2 carrier frequency in Hz.
Definition at line 136 of file DeprecatedConsts.hpp.
const double gnsstk::L2_FREQ_STEP_GLO = 437.5e3 |
GLO L2 carrier frequency step size in Hz.
Definition at line 76 of file DeprecatedConsts.hpp.
const double gnsstk::L2_MULT_GLO = 249.2 |
GLO L2 multiplier.
Definition at line 194 of file GNSSconstants.hpp.
const double gnsstk::L2_MULT_GPS = 120.0 |
GPS L2 frequency in units of oscillator frequency.
Definition at line 98 of file GNSSconstants.hpp.
const double gnsstk::L2_WAVELENGTH_BDS = L7_WAVELENGTH_GAL |
BDS L2 carrier wavelength in meters.
Definition at line 128 of file DeprecatedConsts.hpp.
const double gnsstk::L2_WAVELENGTH_GLO = 0.240603898876 |
GLO L2 carrier wavelength in meters.
Definition at line 78 of file DeprecatedConsts.hpp.
const double gnsstk::L2_WAVELENGTH_GPS = 0.244210213425 |
GPS L2 carrier wavelength in meters.
Definition at line 59 of file DeprecatedConsts.hpp.
const double gnsstk::L2_WAVELENGTH_QZS = L2_WAVELENGTH_GPS |
QZS L2 carrier wavelength in meters.
Definition at line 145 of file DeprecatedConsts.hpp.
const double gnsstk::L3_FREQ_BDS = 1268.52e6 |
BDS L3 (B3) carrier frequency in Hz.
Definition at line 123 of file DeprecatedConsts.hpp.
const double gnsstk::L3_FREQ_GLO = 1202.025e6 |
GLO L3 carrier frequency in Hz.
Definition at line 80 of file DeprecatedConsts.hpp.
const double gnsstk::L3_WAVELENGTH_BDS = 0.236332464604421 |
BDS L3 carrier wavelength in meters.
Definition at line 130 of file DeprecatedConsts.hpp.
const double gnsstk::L3_WAVELENGTH_GLO = 0.249406175412 |
GLO L3 carrier wavelength in meters.
Definition at line 82 of file DeprecatedConsts.hpp.
const double gnsstk::L5_FREQ_GAL = L5_FREQ_GPS |
GAL L5 (E5a) carrier frequency in Hz.
Definition at line 87 of file DeprecatedConsts.hpp.
const double gnsstk::L5_FREQ_GEO = L5_FREQ_GPS |
GEO L5 carrier frequency in Hz.
Definition at line 110 of file DeprecatedConsts.hpp.
const double gnsstk::L5_FREQ_GPS = 1176.45e6 |
GPS L5 carrier frequency in Hz.
Definition at line 55 of file DeprecatedConsts.hpp.
const double gnsstk::L5_FREQ_QZS = L5_FREQ_GPS |
QZS L5 carrier frequency in Hz.
Definition at line 138 of file DeprecatedConsts.hpp.
const double gnsstk::L5_MULT_GPS = 115.0 |
GPS L5 frequency in units of oscillator frequency.
Definition at line 100 of file GNSSconstants.hpp.
const double gnsstk::L5_WAVELENGTH_GAL = L5_WAVELENGTH_GPS |
GAL L5 carrier wavelength in meters.
Definition at line 98 of file DeprecatedConsts.hpp.
const double gnsstk::L5_WAVELENGTH_GEO = L5_WAVELENGTH_GPS |
GEO L5 carrier wavelength in meters.
Definition at line 115 of file DeprecatedConsts.hpp.
const double gnsstk::L5_WAVELENGTH_GPS = 0.254828049 |
GPS L5 carrier wavelength in meters.
Definition at line 61 of file DeprecatedConsts.hpp.
const double gnsstk::L5_WAVELENGTH_QZS = L5_WAVELENGTH_GPS |
QZS L5 carrier wavelength in meters.
Definition at line 147 of file DeprecatedConsts.hpp.
const double gnsstk::L6_FREQ_GAL = 1278.75e6 |
GAL L6 (E6) carrier frequency in Hz.
Definition at line 89 of file DeprecatedConsts.hpp.
const double gnsstk::L6_FREQ_QZS = L6_FREQ_GAL |
QZS LEX(6) carrier frequency in Hz.
Definition at line 140 of file DeprecatedConsts.hpp.
const double gnsstk::L6_WAVELENGTH_GAL = 0.234441805 |
GAL L6 carrier wavelength in meters.
Definition at line 100 of file DeprecatedConsts.hpp.
const double gnsstk::L6_WAVELENGTH_QZS = L6_WAVELENGTH_GAL |
QZS LEX(6) carrier wavelength in meters.
Definition at line 149 of file DeprecatedConsts.hpp.
const double gnsstk::L7_FREQ_GAL = 1207.140e6 |
GAL L7 (E5b) carrier frequency in Hz.
Definition at line 91 of file DeprecatedConsts.hpp.
const double gnsstk::L7_WAVELENGTH_GAL = 0.24834937 |
GAL L7 carrier wavelength in meters.
Definition at line 102 of file DeprecatedConsts.hpp.
const double gnsstk::L8_FREQ_GAL = 1191.795e6 |
GAL L8 (E5a+E5b) carrier frequency in Hz.
Definition at line 93 of file DeprecatedConsts.hpp.
const double gnsstk::L8_WAVELENGTH_GAL = 0.251547001 |
GAL L8 carrier wavelength in meters.
Definition at line 104 of file DeprecatedConsts.hpp.
const long gnsstk::LAST_6SEC_ZCOUNT_OF_WEEK = 403200 - 4 |
Definition at line 47 of file SVPCodeGen.cpp.
|
static |
Definition at line 88 of file DataStatus.hpp.
|
static |
Definition at line 458 of file EngNav.cpp.
const int gnsstk::MAX_BIT = 32 |
Number of bits assumed to be in a unsigned long int.
Definition at line 55 of file PCodeConst.hpp.
const long gnsstk::MAX_GEO_BDS_II = 5 |
The last ranging code number for BeiDou GEO phase II satellites.
Definition at line 211 of file GNSSconstants.hpp.
const long gnsstk::MAX_GEO_BDS_III = 63 |
The last ranging code number for BeiDou GEO phase III satellites.
Definition at line 219 of file GNSSconstants.hpp.
const long gnsstk::MAX_MEO_BDS = 58 |
The last ranging code number for BeiDou MEO/IGSO satellites.
Definition at line 215 of file GNSSconstants.hpp.
const long gnsstk::MAX_PRN = 32 |
The maximum number of active satellites in the GPS constellation.(Old version of MAX_PRN_GPS)
Definition at line 55 of file gps_constants.hpp.
const int gnsstk::MAX_PRN_CODE = 210 |
Maximum PRN Code number (1-n)
Definition at line 58 of file PCodeConst.hpp.
const long gnsstk::MAX_PRN_COM = 63 |
The maximum number of active satellites in the Compass constellation.
Definition at line 207 of file GNSSconstants.hpp.
const long gnsstk::MAX_PRN_GPS = 32 |
The maximum number of active satellites in the GPS constellation.
Definition at line 59 of file gps_constants.hpp.
const int gnsstk::MAX_PRN_QZS = 206 |
Last assigned PRN in QZSS (all signals)
Definition at line 242 of file GNSSconstants.hpp.
const int gnsstk::MAX_PRN_QZS_LNAV = 202 |
Last assigned PRN in QZSS (LNAV only)
Definition at line 244 of file GNSSconstants.hpp.
const long gnsstk::MAX_X2_COUNT = X2A_EPOCH_DELAY + MAX_X2_TEST |
Definition at line 63 of file X2Sequence.hpp.
const long gnsstk::MAX_X2_TEST = 4 * ((XA_COUNT * XA_MAX_EPOCH) + X2A_EPOCH_DELAY) |
Definition at line 61 of file X2Sequence.hpp.
const double gnsstk::maxBias = 999999.0 |
A clock bias >= this is considered bad.
Definition at line 80 of file SP3NavDataFactory.cpp.
const long gnsstk::MIN_GEO_BDS_II = 1 |
The first ranging code number for BeiDou GEO phase II satellites.
Definition at line 209 of file GNSSconstants.hpp.
const long gnsstk::MIN_GEO_BDS_III = 59 |
The first ranging code number for BeiDou GEO phase III satellites.
Definition at line 217 of file GNSSconstants.hpp.
const long gnsstk::MIN_MEO_BDS = 6 |
The first ranging code number for BeiDou MEO/IGSO satellites.
Definition at line 213 of file GNSSconstants.hpp.
const int gnsstk::MIN_PRN_QZS = 193 |
First assigned PRN in QZSS.
Definition at line 240 of file GNSSconstants.hpp.
const long gnsstk::MJD_JDAY = 2400001L |
'Julian day' offset from MJD
Definition at line 53 of file TimeConstants.hpp.
|
static |
Definition at line 53 of file MOPSTropModel.cpp.
|
static |
Definition at line 54 of file MOPSTropModel.cpp.
|
static |
Definition at line 55 of file MOPSTropModel.cpp.
|
static |
Definition at line 56 of file MOPSTropModel.cpp.
|
static |
Definition at line 57 of file MOPSTropModel.cpp.
const long gnsstk::MS_PER_DAY = MS_PER_SEC * SEC_PER_DAY |
Milliseconds in a day.
Definition at line 73 of file TimeConstants.hpp.
const long gnsstk::MS_PER_SEC = 1000L |
Milliseconds in a second.
Definition at line 68 of file TimeConstants.hpp.
|
static |
Definition at line 53 of file NBTropModel.cpp.
|
static |
Definition at line 54 of file NBTropModel.cpp.
|
static |
Definition at line 55 of file NBTropModel.cpp.
|
static |
Definition at line 57 of file NBTropModel.cpp.
|
static |
Definition at line 82 of file NBTropModel.cpp.
|
static |
Definition at line 74 of file NBTropModel.cpp.
|
static |
Definition at line 90 of file NBTropModel.cpp.
|
static |
Definition at line 84 of file NBTropModel.cpp.
|
static |
Definition at line 76 of file NBTropModel.cpp.
|
static |
Definition at line 92 of file NBTropModel.cpp.
|
static |
Definition at line 86 of file NBTropModel.cpp.
|
static |
Definition at line 78 of file NBTropModel.cpp.
|
static |
Definition at line 94 of file NBTropModel.cpp.
|
static |
Definition at line 52 of file NBTropModel.cpp.
|
static |
Definition at line 63 of file NBTropModel.cpp.
|
static |
Definition at line 70 of file NBTropModel.cpp.
|
static |
Definition at line 64 of file NBTropModel.cpp.
|
static |
Definition at line 71 of file NBTropModel.cpp.
|
static |
Definition at line 60 of file NBTropModel.cpp.
|
static |
Definition at line 67 of file NBTropModel.cpp.
|
static |
Definition at line 61 of file NBTropModel.cpp.
|
static |
Definition at line 68 of file NBTropModel.cpp.
|
static |
Definition at line 62 of file NBTropModel.cpp.
|
static |
Definition at line 69 of file NBTropModel.cpp.
|
static |
Definition at line 76 of file NeillTropModel.cpp.
|
static |
Definition at line 86 of file NeillTropModel.cpp.
|
static |
Definition at line 79 of file NeillTropModel.cpp.
|
static |
Definition at line 89 of file NeillTropModel.cpp.
|
static |
Definition at line 82 of file NeillTropModel.cpp.
|
static |
Definition at line 92 of file NeillTropModel.cpp.
|
static |
Definition at line 65 of file NeillTropModel.cpp.
|
static |
Definition at line 68 of file NeillTropModel.cpp.
|
static |
Definition at line 71 of file NeillTropModel.cpp.
const long gnsstk::NUM_6SEC_WORDS = 1918125 |
Number of 4 byte unsigned ints necessary to hold 6 sec of P-code.
Definition at line 64 of file PCodeConst.hpp.
const long gnsstk::NUM_X2_WORDS = 1918131 |
Number of 4 byte unsigned ints necessary to hold an X2 sequence (with leading delay)
Definition at line 67 of file PCodeConst.hpp.
Omega reference value from Table 30-I converted to radians.
Definition at line 108 of file GNSSconstants.hpp.
const double gnsstk::OSC_FREQ_GLO = 5.11e6 |
GLO Fundamental chip rate in Hz.
Definition at line 180 of file GNSSconstants.hpp.
const double gnsstk::OSC_FREQ_GPS = 10.23e6 |
Hz, GPS Oscillator or chip frequency.
Definition at line 88 of file GNSSconstants.hpp.
const long gnsstk::OVERLAP_WORD_POSITION = 1451897 |
Definition at line 59 of file X2Sequence.hpp.
|
static |
Definition at line 89 of file DataStatus.hpp.
const double gnsstk::PI = 3.141592653589793238462643383280 |
GPS value of PI; also specified by GAL.
Definition at line 62 of file GNSSconstants.hpp.
|
static |
|
static |
parts per billion
Definition at line 84 of file GNSSconstants.hpp.
const double gnsstk::PSC_FREQ_GLO = 5.00e6 |
GLO Fundamental oscillator freq in Hz.
Definition at line 187 of file GNSSconstants.hpp.
const double gnsstk::PY_CHIP_FREQ_GLO = OSC_FREQ_GLO |
GLO Chip rate of the P & Y codes in Hz.
Definition at line 182 of file GNSSconstants.hpp.
const double gnsstk::PY_CHIP_FREQ_GPS = OSC_FREQ_GPS |
Hz, GPS chip rate of the P & Y codes.
Definition at line 90 of file GNSSconstants.hpp.
const double gnsstk::QZS_EPOCH_JD = 2444244.5 |
'Julian day' of QZS epoch (Jan. 1, 1980).
Definition at line 110 of file TimeConstants.hpp.
const long gnsstk::QZS_EPOCH_MJD = 44244L |
Modified Julian Date of QZS epoch (Jan. 1, 1980).
Definition at line 112 of file TimeConstants.hpp.
const long gnsstk::QZS_WEEK_PER_EPOCH = 65535L |
Weeks per QZS Epoch.
Definition at line 114 of file TimeConstants.hpp.
Multiply radians by RAD2DEG to get degrees.
Definition at line 66 of file GNSSconstants.hpp.
|
static |
radians per milliarcsecond
Definition at line 82 of file GNSSconstants.hpp.
|
static |
Conversion Factor from radians to degrees (units: degrees)
Definition at line 78 of file GNSSconstants.hpp.
|
static |
Definition at line 459 of file EngNav.cpp.
const double gnsstk::REL_CONST = -4.442807633e-10 |
relativity constant (sec/sqrt(m))
Definition at line 72 of file GNSSconstants.hpp.
const double gnsstk::RSVCLK_GLO = 4.99999999782e6 |
GLO Base freq w/o relativisitic effects in Hz.
Definition at line 189 of file GNSSconstants.hpp.
const double gnsstk::RSVCLK_GPS = 10.22999999543e6 |
Hz, GPS Base freq w/o relativisitic effects.
Definition at line 94 of file GNSSconstants.hpp.
|
static |
Definition at line 62 of file SaasTropModel.cpp.
|
static |
Definition at line 69 of file SaasTropModel.cpp.
|
static |
Definition at line 64 of file SaasTropModel.cpp.
|
static |
Definition at line 71 of file SaasTropModel.cpp.
|
static |
Definition at line 66 of file SaasTropModel.cpp.
|
static |
Definition at line 73 of file SaasTropModel.cpp.
|
static |
Definition at line 54 of file SaasTropModel.cpp.
|
static |
Definition at line 56 of file SaasTropModel.cpp.
|
static |
Definition at line 58 of file SaasTropModel.cpp.
const long gnsstk::SEC_PER_DAY = 86400L |
Seconds per day.
Definition at line 63 of file TimeConstants.hpp.
const double gnsstk::SEC_PER_MS = 1.0/MS_PER_SEC |
Seconds per millisecond.
Definition at line 70 of file TimeConstants.hpp.
RinexObsType gnsstk::sot[29] |
Definition at line 123 of file RinexObsHeader.cpp.
const double gnsstk::SQRT_PI = 1.772453850905516027298167483341 |
GPS value of PI**0.5.
Definition at line 70 of file GNSSconstants.hpp.
const SparseMatrix< double > gnsstk::SRINullSparseMatrix |
constant (empty) SparseMatrix used for default input arguments
|
static |
This array defines how to decode GPS LNav messages for subframeConvert and convertQuant.
Definition at line 84 of file EngNav.cpp.
const double gnsstk::SV_ACCURACY_GLO_INDEX[] |
Map from SV accuracy/URA flag to NOMINAL accuracy values in m. Further details in ICD-GLO-v5.0, Table 4.4 in Section 4.4.
Definition at line 200 of file GNSSconstants.hpp.
const int gnsstk::SV_ACCURACY_GLO_INDEX_MAX = 15 |
Constant for the max array index in SV accuracy table.
Definition at line 197 of file GNSSconstants.hpp.
const double gnsstk::SV_ACCURACY_GPS_MAX_INDEX[] |
map from SV accuracy/URA flag to maximum accuracy values in m
Definition at line 70 of file GPS_URA.hpp.
const int gnsstk::SV_ACCURACY_GPS_MAX_INDEX_VALUE = 15 |
constant for the max array index in sv accuracy table
Definition at line 57 of file GPS_URA.hpp.
const double gnsstk::SV_ACCURACY_GPS_MIN_INDEX[] |
map from SV accuracy/URA flag to minimum accuracy values in m
Definition at line 59 of file GPS_URA.hpp.
const double gnsstk::SV_ACCURACY_GPS_NOMINAL_INDEX[] |
Map from SV accuracy/URA flag to NOMINAL accuracy values in m Further details in ICD-GPS-200C, section 20.3.3.3.1.3
Definition at line 65 of file GPS_URA.hpp.
const double gnsstk::SV_CNAV_ACCURACY_GPS_MAX_INDEX[] |
map from SV accuracy/URA flag to maximum accuracy values in m
Definition at line 102 of file GPS_URA.hpp.
const int gnsstk::SV_CNAV_ACCURACY_GPS_MAX_INDEX_VALUE = 15 |
constant for the max array index in sv accuracy table
Definition at line 75 of file GPS_URA.hpp.
const double gnsstk::SV_CNAV_ACCURACY_GPS_MIN_INDEX[] |
map from SV accuracy/URA flag to minimum accuracy values in m
Definition at line 78 of file GPS_URA.hpp.
const double gnsstk::SV_CNAV_ACCURACY_GPS_NOM_INDEX[] |
map for SV accuracy/Nominal URA indices Further details in IS-GPS-200 30.3.3.1.1.4 IS-GPS-705 20.3.3.1.1.4 IS_GPS-800 3.5.3.5
Definition at line 90 of file GPS_URA.hpp.
const int gnsstk::SV_CNAV_INDEX_OFFSET = 15 |
constant for gps nom index table offset
Definition at line 99 of file GPS_URA.hpp.
const int gnsstk::SV_CNAV_NOMINAL_MAX_INDEX = 30 |
constant for max array index in gps nom index table
Definition at line 96 of file GPS_URA.hpp.
|
static |
Definition at line 55 of file Position.cpp.
const double gnsstk::TWO_PI = 6.283185307179586476925286766559 |
GPS value of PI*2.
Definition at line 68 of file GNSSconstants.hpp.
const long gnsstk::UNIX_MJD = 40587L |
Modified Julian Date of UNIX epoch (Jan. 1, 1970).
Definition at line 55 of file TimeConstants.hpp.
const double gnsstk::WAVELENGTH_BEIDOU_B1 = C_MPS / FREQ_BEIDOU_B1 |
BeiDou B1 carrier wavelength in meters.
Definition at line 150 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_BEIDOU_B1U = C_MPS / FREQ_BEIDOU_B1U |
BeiDou B1U carrier wavelength in meters.
Definition at line 142 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_BEIDOU_B2 = C_MPS / FREQ_BEIDOU_B2 |
BeiDou B2 carrier wavelength in meters.
Definition at line 162 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_BEIDOU_B2a = C_MPS / FREQ_BEIDOU_B2a |
BeiDou B2a carrier wavelength in meters.
Definition at line 166 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_BEIDOU_B2b = C_MPS / FREQ_BEIDOU_B2b |
BeiDou B2b carrier wavelength in meters.
Definition at line 154 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_BEIDOU_B3 = C_MPS / FREQ_BEIDOU_B3 |
BeiDou B3 carrier wavelength in meters.
Definition at line 158 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_BEIDOU_L1 = C_MPS / FREQ_BEIDOU_L1 |
BeiDou L1 carrier wavelength in meters.
Definition at line 146 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_GALILEO_E1 = C_MPS / FREQ_GALILEO_E1 |
Galileo E1 carrier wavelength in meters.
Definition at line 98 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_GALILEO_E5 = C_MPS / FREQ_GALILEO_E5 |
Galileo E5 carrier wavelength in meters.
Definition at line 106 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_GALILEO_E5a = C_MPS / FREQ_GALILEO_E5a |
Galileo E5a carrier wavelength in meters.
Definition at line 110 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_GALILEO_E5b = C_MPS / FREQ_GALILEO_E5b |
Galileo E5b carrier wavelength in meters.
Definition at line 102 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_GALILEO_E6 = C_MPS / FREQ_GALILEO_E6 |
Galileo E6 carrier wavelength in meters.
Definition at line 114 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_GLONASS_G1 = C_MPS / FREQ_GLONASS_G1 |
GLONASS G1 carrier wavelength in meters.
Definition at line 70 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_GLONASS_G1a = C_MPS / FREQ_GLONASS_G1a |
GLONASS G1a carrier wavelength in meters.
Definition at line 74 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_GLONASS_G2 = C_MPS / FREQ_GLONASS_G2 |
GLONASS G2 carrier wavelength in meters.
Definition at line 82 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_GLONASS_G2a = C_MPS / FREQ_GLONASS_G2a |
GLONASS G2a carrier wavelength in meters.
Definition at line 78 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_GLONASS_G2c = C_MPS / FREQ_GLONASS_G2c |
GLONASS G2c carrier wavelength in meters.
Definition at line 86 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_GLONASS_G3 = C_MPS / FREQ_GLONASS_G3 |
GLONASS G3 carrier wavelength in meters.
Definition at line 94 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_GLONASS_G5 = C_MPS / FREQ_GLONASS_G5 |
GLONASS G5 carrier wavelength in meters.
Definition at line 90 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_GPS_L1 = C_MPS / FREQ_GPS_L1 |
GPS L1 carrier wavelength in meters.
Definition at line 58 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_GPS_L2 = C_MPS / FREQ_GPS_L2 |
GPS L2 carrier wavelength in meters.
Definition at line 62 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_GPS_L5 = C_MPS / FREQ_GPS_L5 |
GPS L5 carrier wavelength in meters.
Definition at line 66 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_NAVIC_L5 = C_MPS / FREQ_NAVIC_L5 |
NavIC L5 carrier wavelength in meters.
Definition at line 174 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_NAVIC_S = C_MPS / FREQ_NAVIC_S |
NavIC S carrier wavelength in meters.
Definition at line 170 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_QZSS_L1 = C_MPS / FREQ_QZSS_L1 |
QZSS L1 carrier wavelength in meters.
Definition at line 126 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_QZSS_L2 = C_MPS / FREQ_QZSS_L2 |
QZSS L2 carrier wavelength in meters.
Definition at line 130 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_QZSS_L5 = C_MPS / FREQ_QZSS_L5 |
QZSS L5 carrier wavelength in meters.
Definition at line 134 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_QZSS_L6 = C_MPS / FREQ_QZSS_L6 |
QZSS L6 carrier wavelength in meters.
Definition at line 138 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_SBAS_L1 = C_MPS / FREQ_SBAS_L1 |
SBAS L1 carrier wavelength in meters.
Definition at line 118 of file FreqConsts.hpp.
const double gnsstk::WAVELENGTH_SBAS_L5 = C_MPS / FREQ_SBAS_L5 |
SBAS L5 carrier wavelength in meters.
Definition at line 122 of file FreqConsts.hpp.
const double gnsstk::WEEK_PER_ZCOUNT = 1.0/ZCOUNT_PER_WEEK |
Weeks in a Zcount.
Definition at line 94 of file TimeConstants.hpp.
|
static |
Definition at line 55 of file GPSWeekZcount.cpp.
|
static |
Definition at line 51 of file GPSWeekZcount.cpp.
const int gnsstk::X1_PER_DAY = 57600 |
Number of X1 epochs in one day.
Definition at line 61 of file PCodeConst.hpp.
const unsigned int gnsstk::X1A_INIT = 0x0248 |
INIT variables are starting conditions of 12-bit registers (IS-GPS-200)
Definition at line 70 of file PCodeConst.hpp.
const unsigned int gnsstk::X1A_TAPS = 0x0CA0 |
TAPS variables denote which stages of 12-bit registers are XOR'd.
Definition at line 76 of file PCodeConst.hpp.
const unsigned int gnsstk::X1B_INIT = 0x0554 |
Definition at line 71 of file PCodeConst.hpp.
const unsigned int gnsstk::X1B_TAPS = 0x0F93 |
Definition at line 77 of file PCodeConst.hpp.
const long gnsstk::X2A_EPOCH_DELAY = 37 |
The 37 chip delay at the end of every X2A epoch.
Definition at line 97 of file PCodeConst.hpp.
const unsigned int gnsstk::X2A_INIT = 0x0925 |
Definition at line 72 of file PCodeConst.hpp.
const unsigned int gnsstk::X2A_TAPS = 0x0FDD |
Definition at line 78 of file PCodeConst.hpp.
const unsigned int gnsstk::X2B_INIT = 0x0554 |
Definition at line 73 of file PCodeConst.hpp.
const unsigned int gnsstk::X2B_TAPS = 0x098E |
Definition at line 79 of file PCodeConst.hpp.
const int gnsstk::XA_COUNT = 4092 |
X?_COUNT is the number of bits in an epoch.
Definition at line 86 of file PCodeConst.hpp.
const long gnsstk::XA_EPOCH_DELAY = 0 |
XA_EPOCH_DELAY and XB_EPOCH_DELAY allow for precession of X1B and X2B wrt to X1A and X2A at the end of each X1A epoch and X2A epoch. End of week delays are handled elsewhere.
Definition at line 93 of file PCodeConst.hpp.
const int gnsstk::XA_MAX_EPOCH = 3750 |
X?_MAX_EPOCH is the maximum number of epochs in a sequence.
Definition at line 82 of file PCodeConst.hpp.
const int gnsstk::XB_COUNT = 4093 |
Definition at line 87 of file PCodeConst.hpp.
const long gnsstk::XB_EPOCH_DELAY = 343 |
Definition at line 94 of file PCodeConst.hpp.
const int gnsstk::XB_MAX_EPOCH = 3749 |
Definition at line 83 of file PCodeConst.hpp.
const long gnsstk::ZCOUNT_PER_DAY = 57600L |
Zcounts in a day.
Definition at line 88 of file TimeConstants.hpp.
const long gnsstk::ZCOUNT_PER_HOUR = 2400 |
Z-counts per hour.
Definition at line 98 of file TimeConstants.hpp.
const long gnsstk::ZCOUNT_PER_MINUTE = 40 |
Z-counts per minute.
Definition at line 96 of file TimeConstants.hpp.
const long gnsstk::ZCOUNT_PER_WEEK = 403200L |
Zcounts in a week.
Definition at line 92 of file TimeConstants.hpp.