Public Member Functions | |
def | __init__ (self, a, f) |
def | ArcDirect (self, lat1, lon1, azi1, a12, outmask=GeodesicCapability.STANDARD) |
def | ArcDirectLine (self, lat1, lon1, azi1, a12, caps=GeodesicCapability.STANDARD|GeodesicCapability.DISTANCE_IN) |
def | Direct (self, lat1, lon1, azi1, s12, outmask=GeodesicCapability.STANDARD) |
def | DirectLine (self, lat1, lon1, azi1, s12, caps=GeodesicCapability.STANDARD|GeodesicCapability.DISTANCE_IN) |
def | Inverse (self, lat1, lon1, lat2, lon2, outmask=GeodesicCapability.STANDARD) |
def | InverseLine (self, lat1, lon1, lat2, lon2, caps=GeodesicCapability.STANDARD|GeodesicCapability.DISTANCE_IN) |
def | Line (self, lat1, lon1, azi1, caps=GeodesicCapability.STANDARD|GeodesicCapability.DISTANCE_IN) |
def | Polygon (self, polyline=False) |
Public Member Functions inherited from object | |
template<typename T > | |
T | cast () const & |
template<typename T > | |
T | cast () && |
template<typename T > | |
T | cast () const & |
template<typename T > | |
T | cast () && |
template<> | |
void | cast () const & |
template<> | |
void | cast () && |
object ()=default | |
object (const object &o) | |
Copy constructor; always increases the reference count. More... | |
object (object &&other) noexcept | |
Move constructor; steals the object from other and preserves its reference count. More... | |
object (handle h, borrowed_t) | |
object (handle h, stolen_t) | |
object & | operator= (const object &other) |
object & | operator= (object &&other) noexcept |
PYBIND11_DEPRECATED ("Use reinterpret_borrow<object>() or reinterpret_steal<object>()") object(handle h | |
handle | release () |
~object () | |
Destructor; automatically calls handle::dec_ref() More... | |
Public Member Functions inherited from handle | |
template<typename T > | |
T | cast () const |
template<> | |
void | cast () const |
bool | check () const |
const handle & | dec_ref () const & |
handle ()=default | |
The default constructor creates a handle with a nullptr -valued pointer. More... | |
template<typename T , detail::enable_if_t< detail::is_pyobj_ptr_or_nullptr_t< T >::value, int > = 0> | |
handle (T ptr) | |
template<typename T , detail::enable_if_t< detail::all_of< detail::none_of< std::is_base_of< handle, T >, detail::is_pyobj_ptr_or_nullptr_t< T >>, std::is_convertible< T, PyObject *>>::value, int > = 0> | |
handle (T &obj) | |
Enable implicit conversion through T::operator PyObject *() . More... | |
const handle & | inc_ref () const & |
operator bool () const | |
Return true when the handle wraps a valid Python object. More... | |
bool | operator!= (const handle &h) const |
bool | operator== (const handle &h) const |
PyObject * | ptr () const |
Return the underlying PyObject * pointer. More... | |
PyObject *& | ptr () |
Public Attributes | |
a | |
f | |
Public Attributes inherited from object | |
bool | is_borrowed: handle(h) { if (is_borrowed) { inc_ref() |
Static Public Attributes | |
ALL = GeodesicCapability.ALL | |
AREA = GeodesicCapability.AREA | |
AZIMUTH = GeodesicCapability.AZIMUTH | |
CAP_ALL = GeodesicCapability.CAP_ALL | |
CAP_C1 = GeodesicCapability.CAP_C1 | |
CAP_C1p = GeodesicCapability.CAP_C1p | |
CAP_C2 = GeodesicCapability.CAP_C2 | |
CAP_C3 = GeodesicCapability.CAP_C3 | |
CAP_C4 = GeodesicCapability.CAP_C4 | |
CAP_MASK = GeodesicCapability.CAP_MASK | |
CAP_NONE = GeodesicCapability.CAP_NONE | |
DISTANCE = GeodesicCapability.DISTANCE | |
DISTANCE_IN = GeodesicCapability.DISTANCE_IN | |
EMPTY = GeodesicCapability.EMPTY | |
GEODESICSCALE = GeodesicCapability.GEODESICSCALE | |
int | GEOGRAPHICLIB_GEODESIC_ORDER = 6 |
LATITUDE = GeodesicCapability.LATITUDE | |
LONG_UNROLL = GeodesicCapability.LONG_UNROLL | |
LONGITUDE = GeodesicCapability.LONGITUDE | |
int | maxit1_ = 20 |
int | maxit2_ = maxit1_ + Math.digits + 10 |
int | nA1_ = GEOGRAPHICLIB_GEODESIC_ORDER |
int | nA2_ = GEOGRAPHICLIB_GEODESIC_ORDER |
int | nA3_ = GEOGRAPHICLIB_GEODESIC_ORDER |
int | nA3x_ = nA3_ |
int | nC1_ = GEOGRAPHICLIB_GEODESIC_ORDER |
int | nC1p_ = GEOGRAPHICLIB_GEODESIC_ORDER |
int | nC2_ = GEOGRAPHICLIB_GEODESIC_ORDER |
int | nC3_ = GEOGRAPHICLIB_GEODESIC_ORDER |
tuple | nC3x_ = (nC3_ * (nC3_ - 1)) // 2 |
int | nC4_ = GEOGRAPHICLIB_GEODESIC_ORDER |
tuple | nC4x_ = (nC4_ * (nC4_ + 1)) // 2 |
OUT_ALL = GeodesicCapability.OUT_ALL | |
OUT_MASK = GeodesicCapability.OUT_MASK | |
REDUCEDLENGTH = GeodesicCapability.REDUCEDLENGTH | |
STANDARD = GeodesicCapability.STANDARD | |
tiny_ = math.sqrt(Math.minval) | |
tol0_ = Math.epsilon | |
int | tol1_ = 200 * tol0_ |
tol2_ = math.sqrt(tol0_) | |
tolb_ = tol0_ * tol2_ | |
WGS84 | |
int | xthresh_ = 1000 * tol2_ |
Private Member Functions | |
def | _A1m1f (eps) |
def | _A2m1f (eps) |
def | _A3coeff (self) |
def | _A3f (self, eps) |
def | _Astroid (x, y) |
def | _C1f (eps, c) |
def | _C1pf (eps, c) |
def | _C2f (eps, c) |
def | _C3coeff (self) |
def | _C3f (self, eps, c) |
def | _C4coeff (self) |
def | _C4f (self, eps, c) |
def | _GenDirect (self, lat1, lon1, azi1, arcmode, s12_a12, outmask) |
def | _GenDirectLine (self, lat1, lon1, azi1, arcmode, s12_a12, caps=GeodesicCapability.STANDARD|GeodesicCapability.DISTANCE_IN) |
def | _GenInverse (self, lat1, lon1, lat2, lon2, outmask) |
def | _InverseStart (self, sbet1, cbet1, dn1, sbet2, cbet2, dn2, lam12, slam12, clam12, C1a, C2a) |
def | _Lambda12 (self, sbet1, cbet1, dn1, sbet2, cbet2, dn2, salp1, calp1, slam120, clam120, diffp, C1a, C2a, C3a) |
def | _Lengths (self, eps, sig12, ssig1, csig1, dn1, ssig2, csig2, dn2, cbet1, cbet2, outmask, C1a, C2a) |
def | _SinCosSeries (sinp, sinx, cosx, c) |
Private Attributes | |
_A3x | |
_b | |
_c2 | |
_C3x | |
_C4x | |
_e2 | |
_ep2 | |
_etol2 | |
_f1 | |
_n | |
Static Private Attributes | |
_A1m1f = staticmethod(_A1m1f) | |
_A2m1f = staticmethod(_A2m1f) | |
_Astroid = staticmethod(_Astroid) | |
_C1f = staticmethod(_C1f) | |
_C1pf = staticmethod(_C1pf) | |
_C2f = staticmethod(_C2f) | |
_SinCosSeries = staticmethod(_SinCosSeries) | |
Additional Inherited Members | |
Static Public Member Functions inherited from handle | |
static std::size_t | inc_ref_counter () |
Protected Attributes inherited from handle | |
PyObject * | m_ptr = nullptr |
Solve geodesic problems
Definition at line 85 of file geodesic.py.
def geographiclib.geodesic.Geodesic.__init__ | ( | self, | |
a, | |||
f | |||
) |
Construct a Geodesic object :param a: the equatorial radius of the ellipsoid in meters :param f: the flattening of the ellipsoid An exception is thrown if *a* or the polar semi-axis *b* = *a* (1 - *f*) is not a finite positive quantity.
Definition at line 274 of file geodesic.py.
|
private |
Private: return A1-1.
Definition at line 194 of file geodesic.py.
|
private |
Private: return A2-1
Definition at line 244 of file geodesic.py.
|
private |
Private: return coefficients for A3
Definition at line 322 of file geodesic.py.
|
private |
Private: return A3
Definition at line 399 of file geodesic.py.
|
private |
Private: solve astroid equation.
Definition at line 147 of file geodesic.py.
|
private |
Private: return C1.
Definition at line 204 of file geodesic.py.
|
private |
Private: return C1'
Definition at line 224 of file geodesic.py.
|
private |
Private: return C2
Definition at line 254 of file geodesic.py.
|
private |
Private: return coefficients for C3
Definition at line 339 of file geodesic.py.
|
private |
Private: return C3
Definition at line 404 of file geodesic.py.
|
private |
Private: return coefficients for C4
Definition at line 366 of file geodesic.py.
|
private |
Private: return C4
Definition at line 416 of file geodesic.py.
|
private |
Private: General version of direct problem
Definition at line 1060 of file geodesic.py.
|
private |
Private: general form of DirectLine
Definition at line 1165 of file geodesic.py.
|
private |
Private: General version of the inverse problem
Definition at line 704 of file geodesic.py.
|
private |
Private: Find a starting value for Newton's method.
Definition at line 486 of file geodesic.py.
|
private |
Private: Solve hybrid problem
Definition at line 630 of file geodesic.py.
|
private |
Private: return a bunch of lengths
Definition at line 432 of file geodesic.py.
|
private |
Private: Evaluate a trig series using Clenshaw summation.
Definition at line 121 of file geodesic.py.
def geographiclib.geodesic.Geodesic.ArcDirect | ( | self, | |
lat1, | |||
lon1, | |||
azi1, | |||
a12, | |||
outmask = GeodesicCapability.STANDARD |
|||
) |
Solve the direct geodesic problem in terms of spherical arc length :param lat1: latitude of the first point in degrees :param lon1: longitude of the first point in degrees :param azi1: azimuth at the first point in degrees :param a12: spherical arc length from the first point to the second in degrees :param outmask: the :ref:`output mask <outmask>` :return: a :ref:`dict` Compute geodesic starting at (*lat1*, *lon1*) with azimuth *azi1* and arc length *a12*. The default value of *outmask* is STANDARD, i.e., the *lat1*, *lon1*, *azi1*, *lat2*, *lon2*, *azi2*, *s12*, *a12* entries are returned.
Definition at line 1106 of file geodesic.py.
def geographiclib.geodesic.Geodesic.ArcDirectLine | ( | self, | |
lat1, | |||
lon1, | |||
azi1, | |||
a12, | |||
caps = GeodesicCapability.STANDARD |
GeodesicCapability.DISTANCE_IN |
|||
) |
Define a GeodesicLine object in terms of the direct geodesic problem specified in terms of spherical arc length :param lat1: latitude of the first point in degrees :param lon1: longitude of the first point in degrees :param azi1: azimuth at the first point in degrees :param a12: spherical arc length from the first point to the second in degrees :param caps: the :ref:`capabilities <outmask>` :return: a :class:`~geographiclib.geodesicline.GeodesicLine` This function sets point 3 of the GeodesicLine to correspond to point 2 of the direct geodesic problem. The default value of *caps* is STANDARD | DISTANCE_IN, allowing direct geodesic problem to be solved.
Definition at line 1202 of file geodesic.py.
def geographiclib.geodesic.Geodesic.Direct | ( | self, | |
lat1, | |||
lon1, | |||
azi1, | |||
s12, | |||
outmask = GeodesicCapability.STANDARD |
|||
) |
Solve the direct geodesic problem :param lat1: latitude of the first point in degrees :param lon1: longitude of the first point in degrees :param azi1: azimuth at the first point in degrees :param s12: the distance from the first point to the second in meters :param outmask: the :ref:`output mask <outmask>` :return: a :ref:`dict` Compute geodesic starting at (*lat1*, *lon1*) with azimuth *azi1* and length *s12*. The default value of *outmask* is STANDARD, i.e., the *lat1*, *lon1*, *azi1*, *lat2*, *lon2*, *azi2*, *s12*, *a12* entries are returned.
Definition at line 1069 of file geodesic.py.
def geographiclib.geodesic.Geodesic.DirectLine | ( | self, | |
lat1, | |||
lon1, | |||
azi1, | |||
s12, | |||
caps = GeodesicCapability.STANDARD |
GeodesicCapability.DISTANCE_IN |
|||
) |
Define a GeodesicLine object in terms of the direct geodesic problem specified in terms of spherical arc length :param lat1: latitude of the first point in degrees :param lon1: longitude of the first point in degrees :param azi1: azimuth at the first point in degrees :param s12: the distance from the first point to the second in meters :param caps: the :ref:`capabilities <outmask>` :return: a :class:`~geographiclib.geodesicline.GeodesicLine` This function sets point 3 of the GeodesicLine to correspond to point 2 of the direct geodesic problem. The default value of *caps* is STANDARD | DISTANCE_IN, allowing direct geodesic problem to be solved.
Definition at line 1179 of file geodesic.py.
def geographiclib.geodesic.Geodesic.Inverse | ( | self, | |
lat1, | |||
lon1, | |||
lat2, | |||
lon2, | |||
outmask = GeodesicCapability.STANDARD |
|||
) |
Solve the inverse geodesic problem :param lat1: latitude of the first point in degrees :param lon1: longitude of the first point in degrees :param lat2: latitude of the second point in degrees :param lon2: longitude of the second point in degrees :param outmask: the :ref:`output mask <outmask>` :return: a :ref:`dict` Compute geodesic between (*lat1*, *lon1*) and (*lat2*, *lon2*). The default value of *outmask* is STANDARD, i.e., the *lat1*, *lon1*, *azi1*, *lat2*, *lon2*, *azi2*, *s12*, *a12* entries are returned.
Definition at line 1018 of file geodesic.py.
def geographiclib.geodesic.Geodesic.InverseLine | ( | self, | |
lat1, | |||
lon1, | |||
lat2, | |||
lon2, | |||
caps = GeodesicCapability.STANDARD |
GeodesicCapability.DISTANCE_IN |
|||
) |
Define a GeodesicLine object in terms of the invese geodesic problem :param lat1: latitude of the first point in degrees :param lon1: longitude of the first point in degrees :param lat2: latitude of the second point in degrees :param lon2: longitude of the second point in degrees :param caps: the :ref:`capabilities <outmask>` :return: a :class:`~geographiclib.geodesicline.GeodesicLine` This function sets point 3 of the GeodesicLine to correspond to point 2 of the inverse geodesic problem. The default value of *caps* is STANDARD | DISTANCE_IN, allowing direct geodesic problem to be solved.
Definition at line 1225 of file geodesic.py.
def geographiclib.geodesic.Geodesic.Line | ( | self, | |
lat1, | |||
lon1, | |||
azi1, | |||
caps = GeodesicCapability.STANDARD |
GeodesicCapability.DISTANCE_IN |
|||
) |
Return a GeodesicLine object :param lat1: latitude of the first point in degrees :param lon1: longitude of the first point in degrees :param azi1: azimuth at the first point in degrees :param caps: the :ref:`capabilities <outmask>` :return: a :class:`~geographiclib.geodesicline.GeodesicLine` This allows points along a geodesic starting at (*lat1*, *lon1*), with azimuth *azi1* to be found. The default value of *caps* is STANDARD | DISTANCE_IN, allowing direct geodesic problem to be solved.
Definition at line 1144 of file geodesic.py.
def geographiclib.geodesic.Geodesic.Polygon | ( | self, | |
polyline = False |
|||
) |
Return a PolygonArea object :param polyline: if True then the object describes a polyline instead of a polygon :return: a :class:`~geographiclib.polygonarea.PolygonArea`
Definition at line 1252 of file geodesic.py.
|
staticprivate |
Definition at line 202 of file geodesic.py.
|
staticprivate |
Definition at line 252 of file geodesic.py.
|
private |
Definition at line 315 of file geodesic.py.
|
staticprivate |
Definition at line 192 of file geodesic.py.
|
private |
Definition at line 293 of file geodesic.py.
|
staticprivate |
Definition at line 222 of file geodesic.py.
|
staticprivate |
Definition at line 242 of file geodesic.py.
|
private |
Definition at line 295 of file geodesic.py.
|
staticprivate |
Definition at line 272 of file geodesic.py.
|
private |
Definition at line 316 of file geodesic.py.
|
private |
Definition at line 317 of file geodesic.py.
|
private |
Definition at line 290 of file geodesic.py.
|
private |
Definition at line 291 of file geodesic.py.
|
private |
Definition at line 309 of file geodesic.py.
|
private |
Definition at line 289 of file geodesic.py.
|
private |
Definition at line 292 of file geodesic.py.
|
staticprivate |
Definition at line 145 of file geodesic.py.
geographiclib.geodesic.Geodesic.a |
Definition at line 285 of file geodesic.py.
|
static |
Definition at line 1285 of file geodesic.py.
|
static |
Definition at line 1283 of file geodesic.py.
|
static |
Definition at line 1270 of file geodesic.py.
|
static |
Definition at line 116 of file geodesic.py.
|
static |
Definition at line 111 of file geodesic.py.
|
static |
Definition at line 112 of file geodesic.py.
|
static |
Definition at line 113 of file geodesic.py.
|
static |
Definition at line 114 of file geodesic.py.
|
static |
Definition at line 115 of file geodesic.py.
|
static |
Definition at line 117 of file geodesic.py.
|
static |
Definition at line 110 of file geodesic.py.
|
static |
Definition at line 1272 of file geodesic.py.
|
static |
Definition at line 1276 of file geodesic.py.
|
static |
Definition at line 1264 of file geodesic.py.
geographiclib.geodesic.Geodesic.f |
Definition at line 287 of file geodesic.py.
|
static |
Definition at line 1281 of file geodesic.py.
|
static |
Definition at line 88 of file geodesic.py.
|
static |
Definition at line 1266 of file geodesic.py.
|
static |
Definition at line 1287 of file geodesic.py.
|
static |
Definition at line 1268 of file geodesic.py.
|
static |
Definition at line 100 of file geodesic.py.
|
static |
Definition at line 101 of file geodesic.py.
|
static |
Definition at line 89 of file geodesic.py.
|
static |
Definition at line 92 of file geodesic.py.
|
static |
Definition at line 94 of file geodesic.py.
Definition at line 95 of file geodesic.py.
|
static |
Definition at line 90 of file geodesic.py.
|
static |
Definition at line 91 of file geodesic.py.
|
static |
Definition at line 93 of file geodesic.py.
|
static |
Definition at line 96 of file geodesic.py.
Definition at line 97 of file geodesic.py.
|
static |
Definition at line 98 of file geodesic.py.
Definition at line 99 of file geodesic.py.
|
static |
Definition at line 118 of file geodesic.py.
|
static |
Definition at line 119 of file geodesic.py.
|
static |
Definition at line 1279 of file geodesic.py.
|
static |
Definition at line 1274 of file geodesic.py.
|
static |
Definition at line 103 of file geodesic.py.
|
static |
Definition at line 104 of file geodesic.py.
Definition at line 105 of file geodesic.py.
Definition at line 106 of file geodesic.py.
Definition at line 107 of file geodesic.py.
|
static |
Definition at line 1293 of file geodesic.py.
Definition at line 108 of file geodesic.py.