Skip to main content
Sensors (Basel, Switzerland) logoLink to Sensors (Basel, Switzerland)
. 2019 Feb 27;19(5):1020. doi: 10.3390/s19051020

2D Triangulation of Signals Source by Pole-Polar Geometric Models

Aleksandro Montanha 1,*, Airton M Polidorio 2, F J Dominguez-Mayo 3, María J Escalona 3
PMCID: PMC6427499  PMID: 30818879

Abstract

The 2D point location problem has applications in several areas, such as geographic information systems, navigation systems, motion planning, mapping, military strategy, location and tracking moves. We aim to present a new approach that expands upon current techniques and methods to locate the 2D position of a signal source sent by an emitter device. This new approach is based only on the geometric relationship between an emitter device and a system composed of m2 signal receiving devices. Current approaches applied to locate an emitter can be deterministic, statistical or machine-learning methods. We propose to perform this triangulation by geometric models that exploit elements of pole-polar geometry. For this purpose, we are presenting five geometric models to solve the point location problem: (1) based on centroid of points of pole-polar geometry, PPC; (2) based on convex hull region among pole-points, CHC; (3) based on centroid of points obtained by polar-lines intersections, PLI; (4) based on centroid of points obtained by tangent lines intersections, TLI; (5) based on centroid of points obtained by tangent lines intersections with minimal angles, MAI. The first one has computational cost O(n) and whereas has the computational cost O(nlogn) where n is the number of points of interest.

Keywords: signal processing, 2D point location, computational geometry, pole-polar geometry

1. Introduction

Signals can be of various natures, including sound waves, visible and non-visible light, or other electromagnetic spectrum energies (radio waves or radar waves, for instance). The position of a signal emitter or receiver device can be estimated (located) by triangulating the signal data that it sends/acquires. The signal data comprise: the nature of the own signal (as light (electromagnetic energy), sound and vibration); its intrinsic attributes (such as power, frequency, and amplitude); its extrinsic attributes (as the time when the signal arrives at each particular receiver; the strength and the propagation angle of a signal acquired at each particular receiver). Current approaches used to locate an emitter or a receiver can be deterministic, statistical or machine-learning methods. Thus, we propose to perform this triangulation by geometric models that explore elements of pole-polar geometry. Here, we are presenting five geometric models to solve the point location problem: (1) based on centroid of a set of polar-points (PPC); (2) based on a convex hull region defined by a set of interest points (CHC); (3) based on centroid of a set of interest points obtained by polar-lines intersections (PLI); (4) based on centroid of a set of interest points obtained by tangent lines intersections, (TLI); (5) based on centroid of a set of interest points obtained by tangent lines intersections with minimal angles (MAI).

The first one has computational cost O(n), whereas the others cost O(nlogn). The n value is the number of points of interest.

For a system composed of m receivers, the maximum of polar-points of interest generated is p=(m2)=m!/(2(m2)!). For PPC, CHC and PLI models n=p. For TLI and MAI models n=2p. In terms of m, the cost of proposed methods is O(m2) in accordance with the cost to perform (m2) combinations.

We use IEEE 802.11 Network infrastructures to evaluate the precision of these geometric models, with the aim to acquire strength signal data from emitter-receiver system. The acquired data was not preprocessed. The acquired raw data are used to provide better analysis of the errors committed by the five geometric methods proposed in this work (PPC, CHC, PLI, TLI, and MAI) in comparisons with the errors committed by Newton–Rapson (NRm), Least-Square (LSm), and Weighted Least Squares (WLSm) which have computational cost ~O(m3). This paper does not address operations or methods related with signal data preprocessing. If you have particular interest in these operations, see Section 3.2 in this work. This means that there are errors in the acquired data used in this work. Such errors are due to the signal multipath; the presence of obstacles and the co-presence of other electromagnetic sources (see Section 1.1). The innovation proposed in this work is to use geometric methods to solve a geometric problem (estimation of the location of signal source or a receiver device). Obviously, in order to guarantee the accuracy of a location, it is necessary to ensure data with high quality.

Signal location estimation by range-based methods needs to solve a nonlinear equations system (quadratic equations). To facilitate this solution, the equations of this system are linearized by subtracting equations, that is, any equation of this system is chosen and is used to subtract all other ones from this system, and thus all terms of all equations that have degree two are eliminated from these equations and the system becomes linear. However, the realization of this subtraction also eliminates from the system the equation chosen to perform this linearization. For example, if there were five equations before the linearization, after the linearization there will be four equations in the system. It is important to consider that this equation that was eliminated contemplates data of radial range of the signal acquired by some device of the location network. Eliminating this equation means eliminating this device from this network and its participation on the final result of the location of a point in space becomes indirect. The most complicated fact of performing the linearization of the equations system by subtraction of its equations is in the possibility of propagation of the errors. Assume that the equation chosen to perform the linearization operation is that corresponding to the device that acquired the signal data with the highest error. By using this equation to subtract all other ones, such errors are seriously propagated to the linearized equations system, with impairment for the accuracy of the solution.

In this work we propose five geometric methods capable of estimating the location of a point (2D) without the requirement to solve a nonlinear equations system. This means that all signal radial range data acquired by all devices belonging to a positioning network are used directly to estimate the location of a desired point with computational cost O(m2) without propagating data errors among equations.

1.1. Considerations about Signal Data

In this section we briefly describe about the signal data acquisition and limitations, including the restrictive conditions involved in this acquisition. We try to associate the acquisition of data with the usual methods applied to the spatial location of a point of interest.

What locates what? There are applications which needed estimating the location of an emitter device (e.g., an airplane black box). There are applications which a receiver device needs to be located (e.g., a GPS unit). All methods presented in this paper are able to operate in any of these applications. The experimental cases (Section 3) adopt the convention for locating a receiver device.

The standard techniques range-based applied to location estimation uses a server to that aim. They perform the localization in two steps: (1) ranging, where the radial distance between two sensors (one with known positions and another with unknown position) is obtained, by some methods such as TOA (Time of Arrival), TDOA (Time Difference of Arrival), RSSI (Received Signal Strength Indicator) or AOA (Angle of Arrival) and (2) location computation, where the unknown location of a device is calculated by estimation through methods such as triangulation using the radial distance or angle data [1].

A Received Signal Strength Indicator (RSSI) is a measure of the power contained in a propagated signal. In an IEEE 802.11 system, RSSI refers to received radio signal strength (power level) in a wireless environment, measured in arbitrary units, that a particular signal is received by a receiver. Therefore, the higher the RSSI value is, the stronger the signal is received, and closer are the emitter and the receiver. RSSI-based techniques require the value of the signal magnitude attenuation to find the radial distance among a set of receiver devices. It is a practical and self-organized method that utilizes more power to send a large influx of data to the central server.

Received Signal Strength (RSS)-based fingerprinting approaches have been widely exploited for mobile device localization. The received signal strength is a function of radial distance between emitter and receiver devices. The strength magnitude of a received signal can vary because there are fonts of interferences (noise) in the signal propagation path, especially in outdoor environments [2]. Reference [3] explored signal strength data to feed a Perceptron and Decision Systems based on Learning Vector Quantization to obtain a fingerprint map of that radio strength signal. Reference [4] investigated the effects of hardware orientation, location, measurement time and duration, as well as the interference of the user presence on the RSS acquired data.

In the simplest case of free space propagation, electromagnetic waves radiate out of an isotropic antenna in all directions without being perturbed. The received power, any point in space, for such a case is provided by Friis equation [5,6] given by (1).

ρr=ρegegr(λ4πd)2, (1)
  • ρr and ρe are the receiver and the emitter power

  • gr and ge are the receiver and emitter antennas gains

  • d is the radial distance between an emitter and a receiver in meters.

  • λ is the wavelength. For IEEE 802.11b and g to 2.4 GHz, λ0.125 m and, to 5.7 GHz, λ0.06 m.

The wave propagation of Electromagnetic Radiation (EMR) in the Earth’s free space conditions is compromised primarily by three phenomena [7]: (1) reflection. It happens when EMR interacts with a smooth surface with larger dimension than the wavelength; (2) diffraction, or shadowing. It takes place when the wave is obstructed by objects larger than the wavelength (a secondary wave is created behind the object); and (3) scattering. It occurs when the waves encounter a rough surface whose dimensions are of the same order as the wavelength [6]. As the wireless signal radiates out of the emitter antenna, it may interact with reflective surfaces and be reflected in different directions. If a fraction of this reflected signal reaches the receiver antenna, it will acquire signals from the same emitter that traveled by different paths. The reflected signal may be out of phase with the Line-Of-Sight (LOS) signal that can result in destructive interference and fade the receiver signal. The received signal is affected by different environment components (e.g., the own air) that promote the signal attenuation.

If the signal does not suffer external interference, it is expected an inverse exponential relationship between the radial distance d that the emitter device is there from the position of an AP and the value RSSI ρ of this signal measured in that AP [8]. In the dry air, the signal attenuation A is given by (2).

A=20log10(4πdλ) (2)

Therefore, for a signal propagation in an environment consisting of dry air, we can argue that the signal strength ρr received by the receiver r is dependent of the signal strength ρe that is produced by the emitter e, of the gains gr and ge promoted by sensors antennas and of the attenuation A, (3), promoted by the dry air.

ρr=ρe+ρgA (3)

RSSI is used as a metric in most of distance measurement algorithms that run in indoor environments. Nevertheless, at a more basic level the reliability and precision of using RSSI to determine a spatial position in an outdoor environment has not been extensively experimented and there can be interference caused by structures. This monotonous behavior between the radial distance d and the signal strength ρ is not always observed.

Time of Flight (TOF) are time-based methods for measuring distance using signals data that propagate in a given environment with a known speed v. They consist in measuring the time interval that a wave (e.g., light, radio, or sound) needs to travel a spatial distance. Measuring radio or light wave propagations across small distance requires a clock with subnanosecond time measure; for sound it must be measured by millisecond. TOF-based methods are Time of Arrival (TOA), Time Differential of Arrival (TDOA), and Time of Transfer (TOT).

The emitter and the receiver clocks must be perfectly synchronized for using TOA approach. When an emitter sends a signal at the instant tE, the receiver acquire this signal at instant tR>tE, so, the time interval spent for the signal arrival from emitter to receiver, Δt=tRtE, allows computing the radial distance d that separates the emitter from the receiver by d=vΔt. In the 2D case, knowing the emitter distance from two receivers is sufficient to perform the triangulation of emitter location estimation. The TOT method is an unsynchronized-time approach that computes the radial distance between emitter and receivers based on the time delay of a standardized signal ξ (message) exchanged between the emitter and those receivers.

Accuracy of time acquisition is very important for any type of TOF measurements. An EMR wave travels 1 m in 3 ns in air, thus if a locating system with 1m of accuracy is desired, a 300 MHz clock (least) must be used for time acquisition. Clock accuracy depends on clock granularity, which is associated with the size of the smallest time interval measured by a clock. Larger granularity implies a small time interval, then greater precision [9]. A granularity of 20 ppm has an inaccuracy of 1.2 ms per minute, a rubidium clock has an inaccuracy of 0.06 ns per minute, and a caesium clock has an inaccuracy of 6 ps per minute. To sum up, clock precision is a source of error in TOF methods. The sources of errors can be intrinsic (i.e., related to the hardware) or extrinsic (i.e., related to the environment). Intrinsic errors are related to: (1) clock measurements accuracy; (2) printed circuit board trace (circuit impedance), that means that the electronic signal travels some distance on a printed circuit board trace and this internal path of the signal causes delay on signal propagation; (3) difference in the phases between emitter and receiver; and (4) relative velocity on signal treatment between emitter and receiver, which promotes frequency errors and, hence clock errors. Extrinsic errors comprise: (1) signal reflection; (2) diffraction; (3) scattering; (4) absorption/attenuation; (5) environmentally-dependent the speed signal propagation; and (6) physical model and computational errors (truncation and rounding). Reference [6] outlined sources of error and considerations about some methods of localization using radio frequency.

TOF-based methods suggest inaccuracy does not increase when distance increase. In general, for methods based on RSSI and angle AOA the error increases when distance increase.

To apply the TDOA approach, the clocks of the receivers system or of the emitters system need to be synchronized (e.g., for GPS, only the clocks of the satellites constellation need synchronized—this means that a mobile device GPS unit is not an expensive device). However, each satellite in this constellation needs to send in its signal the coordinates of its spatial position and the precise time registered by its clock. According [7], to estimate a position of a point using a satellite navigation system, it is thus necessary to have two things ready: the position of the satellites and the distance of the point from these satellites. Range observation equations are generated from this information and the position is estimated in 3D space by solving these equations. Therefore, two aspects are important at this point: to obtain this required range data and to solve the equations

1.2. Standard Methods and Considerations

1.2.1. RSSI Approach

The first system used for tracking and locating a mobile device by radio frequency in an indoor environment was RADAR [10]. Previously, [11,12] used the infrared to locate devices. Nevertheless, there are many limitations in the latter when using this range of the electromagnetic spectrum energy to establish communication among sensors and limited results were obtained. In contrast, the RADAR system operates by processing signal strength data at multiple base stations (AP, Access Point) geometrically positioned to provide overlapping coverage in the area of interest. The system enables estimating the location of an emitter by applying empirical measurements with signal propagation modeling.

The empirical models proposed by Equations (4) and (5) present significant disparities when confronted by actual data due to signal attenuation promoted by the floor and walls of an indoor environment. Reference [10] observed that sampled data could be filtered to achieve better results. Considering data median, model (5) provides a precision of 4.3 m, compared to 2.94 m for model (4) and 8.16 m for the strongest signal data values. For the 25th percentile, model (5) provides a precision of 1.86 m, whereas model (4) provides 1.92 m and 4.94 m for the strongest values. To summarize, this evaluation [10] shows that signals can suffer from low and high frequencies interferences (noise). Besides, [10] performed experiments to determine the impact of the data sample size on the result precision. He shows that using two data values by sample, the accuracy worsens by 11%, while using three data values it worsens by 4% (the larger the sample is, the more accurate the result is).

ρ(d)=ρ010log10(dd0)w(nW,C), (4)

Or

ρ(d)=ρ020log10(4πdλ)+xσ, (5)

where,

  • ρ(d) is the signal strength value (dB) expected by an AP located at a radial distance

  • d from the signal origin.

  • ρ0 is the signal strength value (dB) at some reference distance d0.

  • indicates the rate at which the path loss increases with distance (empirical value).

  • w(nW,C) is the signal attenuation factor promoted by walls.

  • λ is the signal wavelength.

  • xσ is a Gaussian noise with zero-mean and variance σ2.

Considering w(nW,C)=0, in free obstructions outdoor environment, and measure ρ0 at d0=1 m from the AP, by (4), the radial distance d can be computed by (6).

d=10ρ0ρ(d)10. (6)

The parameter path-loss exponent (6) depends on the frequency of signal and environment interferences (e.g., walls, buildings, cars, rain, air moisture, or people); for open free space, 2, and for environments with obstructions, >2. A more appropriate value can be determined in the system calibration phase [13]. Experiments carried out by [14] showed that in an urban area, the path loss variation ranges 2.73.5, using a cellular radio.

1.2.2. Time-Based Approaches (ToA and TDoA)

Reference [15] use sound waves to locate a receiver device using signal data based on TDoA measurements. The location computation is formulated as an optimization problem applying a set of constraint previously determined. The basic idea is to shrink the radius of all circles at a constant step length until the intersection area reaches a small threshold. This operation needs to perform N acquisitions of data (called phase). For each set of acquired data is applied an optimization algorithm. These acquisitions of data end when the optimization algorithm finds a solution considered satisfactory. The computational complexity of the proposed method is about O(10(nN2+n2N)), where n is the number of nodes (emitters).

Time-based approaches are based on electromagnetic (or sound) wave propagation that moves at a speed v close to light speed, c3×108 m/s (in the vacuum). In the Earth’s atmosphere v=c/n, n is the refraction coefficient of the atmosphere (n=1.000292 to dry air at conditions 0 °C and 1 atm. The accurate value is v=299,704,944  m/s). The physical model (7) responsible for computing the radial distance d between emitter and receiver depends only on the instant tE when the emitter sends the signal and the instant tR when the receiver get it.

d=v(tRtE) (7)

The model (7) can be applied only in case that emitter and receiver are time-synchronized. Ensuring this synchronization is not always a simple task. It must be considered that v is an astronomical quantity and small deviations of precision in (tRtE) results in large errors (for each 1 ms error in the time registration there can be a location error higher than 300 km).

1.2.3. Generalization of 2D Location Function Range-Based

In 2D space (x,y) are two unknowns for the location of a point P. In Cartesian coordinates, the point (x,y) can be represented in terms of its range by (xx1)2+(yy1)2=(r1)2, where (x1,y1) is a known reference point and r1 is the range (or radial distance) between the unknown point (x,y) and the reference point (x,y). To solve (x,y) is necessary a second observation given by another reference point (x2,y2) that generates the new circle equation (xx2)2+(yy2)2=(r2)2. There are two solutions for these two quadratic equations. If these two solutions are the same, then these two circles are tangent and the solution for P is found. If these two circles are secant, P has two ambiguous solutions. In this case, to obtain the correct solution is necessary known a third reference point (x3,y3) and its respective r3 range to P. This is known as trilateration, the estimation of the position of a point unambiguously based on the measurements of distances from three or more known reference locations [7]. Otherwise, these three circles do not intercept at a single point because there are errors in ranges measurements. In this case, the solution for P is inaccurate and need to be estimated with error minimization. To provide this error minimization it is necessary known others reference points (xk,yk) and its respective ranges rk—see Equation (8). As the Cartesian plane is concerned, the Euclidean distance between two points P0(x0,y0) and P1(x1,y1) is given by d=(x1x0)2+(y1y0)2, so, by means of (6) or (7), the relationship (x1x0)2+(y1y0)2=(v(tRtE))2=102ρ0ρ(d)10 is obtained, which is the circle equation with radius r=v(tRtE)=10ρ0ρ(d)10 and center (x0,y0). If P0 represent the receiver position and P1 the emitter position, the emitter belongs (best case) to this circle line and the receiver is at the circle center. Note that signal-based location methods need to know the value of the radial range of the signal r regardless of whether this value is estimated by strength data or the wave propagation speed of that signal. Despite of how the value of r is estimated, such methods do not change. Therefore, performing experiments using signal strength and signal propagation velocity data is irrelevant to compare the accuracy achieved by different methods.

The radial distance (or range data) d=r between emitter and receiver is identified through (6) or (7). Using this concept to m>2 receivers by one emitter, the following is obtained (8)

F(x,y)={(xx1)2+(yy1)2(r1)2=0(xx2)2+(yy2)2(r2)2=0(xxm)2+(yym)2(rm)2=0 (8)

The Equation (8) is a nonlinear equations system to solve the emitter location (x,y). If m=2, this equations system is normal and can be solved either by a numerical or empirical method or applying the analytical solution showed in Figure 1a. If m>2, the system is redundant and allows minimizing the solution error by means of Nonlinear Least-Squares (NLLS).

Figure 1.

Figure 1

(a) Analytical solution to (x,y) when there is an intersection between circles. (b) Possible tangential straight lines t1 and t2 for the circle line obtained by an external point E(xe,ye) (pole-point). Polar-line p and its geometric relationship with the tangent lines and a given conic section (circle in this case).

1.2.4. How to Solve the System

The following are some possible solutions for the system of nonlinear equations given in (8). Solution by Least-Squares Method—For this solution [16] proposes a linearization of the non-linear equation system (8). This linearization is achieved when an equation of the system (8) is used to subtract all the others. By performing this subtraction, the system (8) with non-linear equations results in a system of m1 linear equations. In this case, to solve a 2D location problem, m3 receivers are necessary. For example, if the equation 1 of (8) is chosen to perform this linearization, then the resulting linear system, written in the form M[x,y]t=b, is given by (9). The solution of M[x,y]t=b is given by [x,y]t=M1b, if m=3, or by [x,y]t=(MtM)1Mtb, if m>3.

M=[x2x1y2y1x3x1y3y1x4x1y4y1xmx1ymy1]m1×2 and b=12[b2b1b3b1b4b1bmb1]m1×1 (9)

where bk=rk2(xk2+yk2), for k=1,2,3,,m.

Note that these solutions have any mechanism to handle errors involved with the acquired data. The position solution obtained by (9) was based upon a fundamental assumption that the ranges have no error in them. However, the same approach is valid when the range errors for all the reference points are statistically independent and identical. However, this is not true in real cases. Often, this error is neither independent nor identical. Under such conditions, the least squares position estimate does not hold good as an optimal estimate. If the range errors are Gaussian and the covariance of ranging errors is given by the matrix Σ, then the optimal estimation for location is given by the Weighted Least Squares (WLSm) provide by [x,y]t=(MtΣ1M)1(MtΣ1b) [7,16,17].

Solution by Numerical Method—For this specific case, the Jacobian matrix J (10) is the matrix of first order partial derivatives of F(x,y), such that, J(F(x,y)) is given by

J(F(x,y))=[f0xf0yf1xf1yfm1xfm1y],

applying in (8)

J(F(x,y))=2[xx0yy0xx1yy1xxm1yym1] (10)

We look for F(x,y)=0. For m=2, an interactive solution for F(x,y)=0 is found by Newton’s method [18], by way (11)

[xk+1yk+1]2×1=[xkyk]2×1[J(xk,yk)]2×21[F(xk,yk)]2×1 (11)

where k=0,1,2,. is kth iteration, [F(xk,yk)]m×1 is vector function, [J(xk,yk)]2×m1 is the inverse of the Jacobian matrix, and (x0,y0) is the first estimative for the solution. Such solution is found when [xk+1,yk+1]t[ε,ε]t, and ε stands for the precision value specified a priori. If m>2 and Xk=[xk,yk]t, the system (8) can be solved by (12).

Xk+1=XkF(Xk)([J(Xk)]t[J(Xk)])1[J(Xk)]t (12)

Algebraic Solution—An algebraic 3D solution to locate a receiver ([19] aimed to locate a receiver using TDOA measurements and four satellites emitters) was found out by [19], Bancroft’s method, which reduces the problem to solve a quadratic equation and yields the 3D Cartesian coordinate of the receiver as well as the common time of signal transmission. It also performs several algebraic manipulations to reduce the equations to a least-squares problem. The presented solution (13) considers that

r˜i2=(riξi)2=piρ2=(xxi)2+(yyi)2+(zzi)2, (13)

where, ri and r˜i are the observed and actual radial distances (pseudorange and actual range, respectively); ξi is the measurement noise at the receiver corresponding to the measurement between the ith satellite and the receiver, respectively and ρ is the receiver position (x,y,z) to determine. A generally acceptable modeling of the ranging error ξi was described in [20]. Thus, using the receiver clock bias b=ξi as the only noise measurement and applying some algebra the following equation is obtained

(xi2+yi2+zi2ri2)2(xix+yiy+zizrib)+(x2+y2+z2r2)=0.

Let ρ=[xyzr]t denotes the receiver position vector and pi=[xiyiziri]t denotes the satellite position and range vectors. According to Lorentz inner product for 4-space (given by u,v=u1v1+u2v2+u3v3u4v4), can be rewritten as

12pi,pipi,ρ+12ρ,ρ=0.

Now, the solution can be found utilizing least-squares estimation to the organized satellites equations in the matrix Bm×4=[xkykzkrk],k=1m and the vector am×1=12[pk,pk]. The final solution demands a consistency analysis of the partial results found.

Analytical Solution—When two circles with centers at (x1,y1) and (x2,y2) and radius r1 and r2 intersect at one or two points P(xp,yp) and Q(xq,yq). This intersection do not always occurs due to noise and underestimation of ranges [21]. The analytical solution (x,y) is found at the median of the straight line segment s that connects P and Q points (Figure 1a), given by (14)

(x,y)=(xp+xq2,yp+yq2), (14)

where

  • xp=E+GH; xq=EGH; yp=ABxpC; yq=ABxqC;

  • A=r12r22x12y12+x22+y22; B=2(x1x2); C=2(y1y2); L=BC; D=1+L2;

  • E=2(L[1A]x1); F=L(L2y1)+x12+y12r12; G=E24DF; H=2L.

For a normal equation system another analytical/algebraic solution for (8) can be obtained performing the linearization by row (equations) subtraction and then applying the Gauss–Jordan elimination method [18].

Despite the method chosen to solve this problem (analytical, algebraic, least-squares, numerical or NLLS), there are invariable errors associated with the acquired data. These errors are propagated by computational arithmetical operators, mainly multiplication and division.

It is necessary to minimize the number of arithmetic operations involved in the solution in order to improve the accuracy of the results and, therefore, reduce the computational cost to provide facilities for designing of real time systems. This work proposes a geometry-based solution with the aim to minimize the number of arithmetical operations so as to find the desired solution.

1.3. Useful 2D Geometric Definitions

This subsection describes some geometric important definitions for understanding the proposed geometric models. Such definitions are labeled as, for example, (d-9) which means the 9th definition and its uses are thus referenced in the text. References [22,23] provide these definitions and further information in this regard.

Point and Line—A coordinate P(x,y) define the point P in the Cartesian plane (2). The line that passes through the points P(x1,y1) and Q(x2,y2), PQ, is denoted PQ. The line segment PQ¯ (with endpoints P and Q) is the portion of the line PQ between points P and Q.

  • (d-1) 
    The Euclidean distance DPQ¯ between two points P(x1,y1) and Q(x2,y2) is given by
    DPQ¯=(x1x2)2+(y1y2)2.
  • (d-2) 

    For constants A, B, C (A and B not both zero) all points (x,y) satisfying the equation

    Ax+By+C=0 define the implicit line equation in the Cartesian plane. For two points P(x1,y1) and Q(x2,y2), a particular PQ line equation is obtained by
    A=y1y2; B=x2x1; C=Ax1By1.
  • (d-3) 
    Two particular lines A1x+B1y+C1=0 and A2x+B2y+C2=0 have an interception at the point (x+,y+), if d=A1B2A2B10, given by
    (x+,y+)=(B1C2B2C1d,A2C1A1C2d),
    if A1A2+B1B2=0, lines are perpendicular. If A1B2=A2B1, lines are parallel or coincident.
  • (d-4) 
    The angle θ formed between two particular lines is given by
    tanθ=A1B2A2B1A1A2+B1B2.
  • (d-5) 
    The line equation Apx+Bpy+Cp=0 that passes through point P(xp,yp) and is perpendicular to the line Ax+By+C=0 is defined as
    Ap=B; Bp=A;  Cp=AxpByp.

    Circle—In the Cartesian plane the equation (xxc)2+(yyc)2=r2 defines the implicit circle equation centered at the point C(xc,yc) with radius r. Let E(xe,ye) be an external point to a circle. By using E we can obtain two tangent lines, t1 and t2, to the circle (Figure 1b), which pass through points P(x1,y1)* and Q(x2,y2)*, respectively. Points P and Q can be computed by applying the geometric concept of pole-polar definition.

    Pole-Polar Geometry—Pole-point and polar-line are, respectively, a point and a line that have a unique reciprocal relationship with respect to a given conic section. If the point lies on the conic section, its polar-line is the tangent line to the conic section at that point [24]. If the pole-point is external to the conic section, the polar-line intercepts the conic section exactly at the points that allow passing tangent lines from this pole-point (Figure 1b). Our interest is to pass two tangent lines, t1 and t2, through a circle centered at point C(xc,yc) with radius r. Moreover, these lines must pass through a known external point E(xe,ye) (or pole-point) to this circle (Figure 1b). We need to locate the coordinates of the polar-points P(x1,y1)* and Q(x2,y2)*, which define the polar-line p and lies to the tangents lines t1 and t2. Additionally we must find the equation of the polar-line p(Ax+By+C=0).

  • (d-6) 

    The general equation of a conic in the Cartesian coordinate system is given by axxx2+2axyxy+ayyy2+2bxx+2byy+w=0. We need the equation of the polar-line p(Ax+By+C=0) that can be obtained by a known pole-point E(xe,ye). The required coefficients of the respective polar-line p is given by: A=axxxe+axyye+bx; B=axyxe+ayyye+by; C=bxxe+byye+w. In this work, the expected conic section is a circle. For the circle case, the following simplifications are helpful: axx=1; axy=0; ayy=1; bx=xc; by=yc and w=xc2+yc2r2.

    The next step consists in placing points P(x2,y2)* and Q(x2,y2)*, which are obtained by computing the intersection between the polar-line p and the circle line (Figure 1b). To compute the intersection of a line, Ax+By+C=0, with a circle, (xxc)2+(yyc)2=r2, the following conditions must be considered: dlc=|Axc+Byc+C|A2+B2 is the distance between the line and the circle center point C(xc,yc),
    • if dlc>r, there is no intersection point;
    • if dlc=r, the line is tangent to the circle and has one intersection point;
    • if dlc<r, the line is secant to the circle and has two intersection points.

    The algebraic solution for this intersection is an equation of degree two. Another way to solve this intersection is applying some geometric relationships, as follows. To find the intersections points P(x1,y1)* and Q(x2,y2)*, which are the polar-points, we have first to drop a perpendicular line (by d-5) from the center C(xc,yc) of the circle to the line p. Let T(xt,yt) be the intersection point and CT be the line that passes through C and T (Figure 1b).

    The equation of line p(Ax+By+C=0) is known (by d-6). Thus, the equation of line CT is CT(Bx+Ay+AxcByc). This way, the point T(xt,yt) can be computed by intersection between p and CT lines (by d-3).

    DCT¯ represents the Euclidean distance between points C and T; DPT¯ refers to the distance between points P and T; DQT¯ stands for the distance between points Q and T; and DCP¯=DCQ¯=r (by d-1).

    The triangles ΔCPT and ΔCQT are right-angled, and hence we prove that
    DCT¯2+DPT¯2=r2,
    and
    DCT¯2+DQT¯2=r2.
  • (d-7) 
    So, DQT¯=DPT¯=h=r2DCT¯2; now, if we translate the point T by h units in both directions along line p, the points P and Q are determined as follows
    (x1,y1)*=(xtBhA2+B2,yt+AhA2+B2),
    and, if h0
    (x2,y2)*=(xt+BhA2+B2,ytAhA2+B2).

    The suggested geometric models that use the convex hull algorithm (CHC, PLI, TLI, and MAI) need to minimize the region of interest (ROI) and exclude bad points from final results. This minimization of ROI is obtained by obtaining a convex polygon defined on a set of previously computed points. A set S is convex if x,ySxy¯S. Any region (polygon) with a “dent” is not convex [24]. The convex hull of a set of points is the smallest convex set containing these points [24,25,26].

  • (d-8) 

    The convex hull algorithm is used in this work to specify a Region of Interest (ROI).

    To illustrate the use of the convex hull we must consider the existence of three receivers centered at coordinates C1C2C3 (and these coordinates cannot all be collinear) that collect a signal from a point with distance r1,r2 and r3 (radial distance), respectively. Pkj and Qkj, kj, represents the polar-points that lie to the circle centered in Cj that is obtained by the external point Ck (center of another circle), as Figure 2a shows. Thus, the smallest convex polygon that contains all obtained polar-points is the convex hull for these points and this minimal polygon defines our ROI. This region in red-color lines is used to illustrate the ROI for the proposed geometric models presented below (always representing a convex hull to define a ROI).

  • (d-9) 
    The location estimation of the emitter, Exy(Ex,Ey), is based on a set S that contains n points, (x,y), which are collected in a defined ROI. This location is given by the centroid point among all points in S, by
    Ex=xSxn, Ey=ySyn

Figure 2.

Figure 2

(a) Illustration of Convex Hull algorithm applied to a set of polar-points. (b) An example of signal data and it respective signal ranges with its polar points. This case represents sets of signal data with satisfactory quality. The red dotted rectangle mark a region where a set of polar points enveloping the location of an emitter device.

Section 2 presents the models (methods) proposed in this work. All examples illustrated in Section 2 are generated in a simulator system (MatLab code) that implements the respective proposed models. This simulator is available for download (www.coding2change.org/articles/GeometricModels.zip). The simulated cases presented in this work use systems composed by three, four, or five receivers, but the simulator is able to operate with any number (>1) of receivers.

The Figure 2b presenting a Cartesian system to locate points in meters. In all figures bellow that involves example of location problems the description of the axes (label) were omitted. The axes x and y represents the Cartesian system to locate a point in the plan. The coordinate values are free of linear unit (meters, feet, or geographic coordinates).

2. The Proposed Geometric Models

The proposed geometric models are applicable to m2 receivers and one emitter. A system comprises m receivers to triangulate the emitter location Exy(Ex,Ey) by geometric relationship applying elements of pole-polar geometry.

Our algorithmic descriptions (and the simulator) use as input data the coordinates of each receiver position Ck(xk,yk), k=1,2,,m and its respective signal range rk. In real world, these signal ranges values are computed from acquired signal data by each receiver using, for example, a time-based or strength-based model. Only after can be applied a method capable to triangulate the signal emitter device location.

In this section we present the proposed geometric methods. To evaluate such methods, we developed an experiment, in an outdoor environment, capable of acquiring signal strength data (Section 3). In this environment we define a local coordinate system that allows controlling the geometry of the localization system and guarantees precision in the positioning of the emitters and the receiver. The analyses of the acquired data in this experiment, the results produced by the application of the proposed methods and comparisons with results obtained by other three methods are in Section 3.2 and Section 3.3.

2.1. Accurate Data, Exact Result

Before presenting the five proposed geometric models to solve the problem of locating a signal source, we present now the perfect solution, if the acquired signal data are accurate and if the spatial geometric arrangement among the receivers be symmetric along the x-axis and y-axis. This exact solution has complexity O(n).

All the geometric models proposed in this work are based on the calculation of polar points, which belong to a circle line (signal range). If it is certain that the data acquired from the signal are accurate, the solution for the location of the signal source is immediate. According to ISO 5725-1, the term “accuracy” is used to describe the closeness of a measurement to the actual value.

The Figure 2b, Figure 3c, Figure 4b,c illustrate some cases that involve accurate signal data and therefore must have exact solutions. The Figure 3c is the perfect case using a system composed by m=3 receivers. The Figure 4b,c show perfect cases using a system with m=4 receivers. In fact, the case presented in Figure 3c is almost perfect. The signal data has been purposely shifted from perfection to being able to see that in the red dotted rectangle there is more than one polar point (there are four). If the data were accurate, these four polar points would self-overlap at the intersection point among the lines of these three circles. See in Figure 3c that the solution pointed out by the geometric model PPC (green rectangle) is not exact. The reason for this divergence is explained in the description and analysis of the PPC model (Section 2.2). For the case illustrated in Figure 3c, the exact solution is obtained by the set of polar points that overlap the point of intersection among the lines of the circles.

Figure 3.

Figure 3

Results produced by Polar-Points Centroid Model (PPC). (a,b) show the possible presence of noise in acquired data. (c) Represents the best case for acquired data because the signal data are quasi-exact. The red dotted rectangle mark all (four) polar points that belong to all circle lines (signals range). The exact solution is one of these points (see Section 2.1).

Figure 4.

Figure 4

(a) Incoherence in data. The spatial position of a receiver is inside of range of another receiver. In this case, some polar-points are complex numbers (see the polar-points out of the line circles)—but their real parts belong to the region of interest (ROI). (b) Accurate data. Exact solution produced by PPC using redundant data (four receivers). For this case, is better applying the exact solution providing by Section 2.1. (c) Accurate data. A collinear arrangement among receivers (geometric arrangement not recommended) and the exact solution provided by PPC. The solution to this problem is impossible for Weighted Least Squares (WLSm), Least-Square (LSm), and Newton–Rapson (NRm).

If the signal data are accurate, the exact solution is given by a single point, among all the polar points, that having the property to belongs at the same time to all circles lines (signal ranges). The formal proof for this exact solution is obtained by construction, or proof by example, which requires the construction of a concrete example with exact solution to show that some polar point is the exact solution because have the property to belongs to all circles lines. To verify this proof, use the proposed PPC method (Section 2.2) provided in the simulator system (see Section 4). Using the simulator, you can construct examples of ideal situations (all lines of circles must intersect at a single point and the geometric arrangement of the receivers in the plane must respect aspects of non-collinearity and neither all them can be located in the range of another receiver). If these conditions are met, the PPC method will determine one or more polar-points over that single point of intersection among all circle lines and/or determine the solution over that intersection.

To obtain the exact solution we must discover at least one polar point that has the property of belonging to all circles lines. The number of polar points that have this property depends on the geometric arrangement among the position of the receivers. For example, the arrangement presented in the Figure 3c has four polar points with this property. For Figure 4b, there are eight polar points. For Figure 4c, although the data is perfect, there is no polar point that has this property. Regardless of the number of receivers m used in the system, the maximum number of polar points that can have this property is eight.

The Figure 2b shows a system composed of four receivers. As you can see the lines of all circles do not intersect at a single point. In this case, there is some error associated with the signal data. Even so, we can admit that the data quality is satisfactory.

If the geometric arrangement among the position of the receivers is favorable and if the quality of the signal data is high there will always be an expressive set of polar points involving the location of the signal-emitting device. If the system consists of m3 receivers, find all polar points that are closest to each other. The centroid point (green rectangle in Figure 2b) among these selected points is the best solution to estimate the location of the signal emitter device. This can be done by stipulating a distance value as a threshold (acceptable error value) and verifying that each polar point is located a distance less than that threshold with respect to the lines of all circles (signal range). If there is a single circle line that is at a distance greater than the stipulated threshold from the point-candidate under analysis then that point must be discarded, otherwise it is selected.

However, receiving high signal data is an almost unlikely task. In this way, this work does not consider this eventual possibility as a solution. Our intention is to present new methods applied to signal triangulation problems and to analyze their behavior in the face of the errors inherent in the signal data.

2.2. Polar-Points Centroid Model (PPC)

The Figure 3 and Figure 4 show a set of possible cases of signal data and the respective application of PPC model (Algorithm 1). Figure 4a,c presents an intrinsic example of data incoherence, when the spatial position of a receiver is inside the signal range of another receiver, due to the presence of noise or excessive gain applied to the antennas. Even so, the results produced are consistent with data and no singularity was generated. If this case is possible, then some polar-points are complex numbers in the form a+bi. However, the proposed models have their origins in the polar geometry projection, which is also used to represent complex numbers. This means that the real part, real(a+bi)=a, of a complex polar-point can be used as an approximate value to represent an actual polar-point. Another way is to exclude all generated complex numbers from partial results. In this work, those complex numbers are not excluded. This option shows that the proposed geometric models are capable to solve these data incoherence producing a consistent result (Figure 4a,c, Figures 8b and 13).

Figure 3c displays the optimal case for real application. The emitter location should be in the common intersection point among the three receiver range circles. Although the result was close to this point, there is no perfect match, because there are polar-points that do not have the pattern responsible for symmetrically enveloping the emitter location. These polar-points are bad points. Using redundant data, by applying m>3 receivers to the system, these non-symmetrical points will have low influences on results (Figure 4b).

Figure 4c present an atypical geometric arrangement for a system used to solve signal triangulation problems. All receivers are arranged in a straight line (they are collinear). It is not all triangulation methods that can solve the problem with this arrangement. The PPC resolves and, if the data is accurate, the solution can be exact.

Algorithm 1. PPC—Polar-Points Centroid Model
Data Input
m2 is the number of receivers.
Ck(xk,yk), k=1,2,,m, is the planar position of each receiver.
rk,k=1,2,,m, is the signal range of each receiver to an emitter.
Procedure
1: for each k=1,2,3,,m
 2: k,j:1,2,,m/kj, by (d-6) and (d-7), for each receiver position Ck, used as pole-points, compute all combinations of polar-points Pkj(xpkj,ypkj) and Qkj(xqkj,yqkj) with the respective receiver at position Cj and signal range rj.
 3: store the points Pkj and Qkj in the set (SS{Pkj,Qkj}).
4: end for
5: Apply (d-9) in the set S, compute the location estimation, Exy(Ex,Ey), of the emitter.
Information Output
6: Emitter location estimation Exy(Ex,Ey).

2.3. Convex Hull Centroid Model (CHC)

Figure 5a,b shows results closer to the solutions together with those shown in Figure 3a,b. Nonetheless, the result shown in Figure 6 is better than that of Figure 3c and Figure 5c. This improvement in accuracy is related to the exclusion of non-symmetrical polar-points (called bad points) to the emitter actual location.

Figure 5.

Figure 5

Results produced by Convex Hull Centroid Model (CHC). (a,b) highlight the possible presence of noise in acquired data. (c) Represents the best case for acquired data. For this case, is better applying the exact solution provided by Section 2.1.

Figure 6.

Figure 6

Results produced by CHC using satisfactory redundant data (four receivers). For this case, is better applying the exact solution provided by Section 2.1.

It must be noticed that in Figure 6 the set of polar-points, adding a new receiver to the system, allows obtaining a region (ROI) more symmetrical to the emitter actual position. Accuracy in results improves by adding new receivers to the system. This filtered ROI is more symmetrical, both PPC and CHC (Algorithm 2) produce the same correct result.

Algorithm 2. CHC—Convex Hull Centroid Model Algorithm
Data Input
m>2 is the number of receivers.
Ck(xk,yk), k=1,2,,m, is the planar position of each receiver.
rk,k=1,2,,m, is the signal range of each receiver to an emitter.
Procedure
1: Execute the steps 1 until 4 of algorithm Polar Points Centroid Model.
2: Apply (d-8), find the convex hull polygon for all polar-points in S. The obtained polygon is the minimal convex polygon that involves all interest points in S. This polygon constitutes the ROI.
3: Exclude all polar-points on the boundary of this convex polygon, called bad polar-points, from S.
4: Apply (d-9) in S, compute the location estimation, Exy(Ex,Ey), of the emitter.
Information Output
5: Emitter location estimation Exy(Ex,Ey).

When the acquired data are coherent, the responses produced by the two models are similar (Figure 7b). If there are some discrepancies on the data, there may be divergences among the results (Figure 7a). Consequently, data errors promote differences in results. In this work, we do not evaluate data quality, but show consistency of results presented by the proposed models, whenever there is guarantee on the data quality.

Figure 7.

Figure 7

Different cases and respective responses of the PPC and CHC models. (a) Five receivers system. The data has some discrepancies. (b) Four receivers system. The data has small inconsistencies. For both cases, is better applying the solution provided by Section 2.1.

2.4. Polar Lines Intersections Model (PLI)

The polar-line p is a line that passes through two corresponding polar-points P(x1,y1)* and Q(x2,y2)* that belongs to a line of a conic section (circle in this case). These polar-points are obtained by a given pole-point E(xe,ye) (Figure 1b). The PLI model (Algorithm 3) consists finding all combinations of pole-polar lines using as pole-points the position of each receiver at a time. After, we must compute the points of intersection among all these lines.

Figure 8a represents cases of data underestimation provide by sensors. Figure 8b shows a good case for real application. The emitter location should be on the common intersection point among the receiver range circles. Figure 8c shows the exact result. Reliable data quality improves accuracy.

Figure 8.

Figure 8

Results produced by Polar Lines Intersections Model (PLI). (a,b) show the possible presence of noise in acquired data. (c) Represents the best case for acquired data. For this case is better applying the exact solution provided by Section 2.1.

A lot of pole-polar lines pairs, in the geometry arrangement with m receivers, are parallel lines (Figure 8 and Figure 9); this minimizes the number of intersection points. For m>3 receivers, several bad intersections points are generated. The convex hull among polar-points establishes a ROI that ensures better symmetry among the points of interest. For large values of m, many intersections will occur very far from the ROI, breaking then the desired symmetry among these points (Figure 9). The Pole-Polar Lines Intersections model achieves accurate values for emitter location because it generates significant symmetrical points of interest.

Figure 9.

Figure 9

Result produced by PLI four receivers system. The non-symmetrical points are removed from the ROI by the use of Convex Hull. For this case is better applying the exact solution provided by Section 2.1.

Algorithm 3. PLI—Polar Lines Intersections Model Algorithm
Data Input
m3 is the number of receivers.
Ck(xk,yk), k=1,2,,m, is the planar position of each receiver.
rk,k=1,2,,m, is the signal range of each receiver to an emitter.
Procedure
1: for each k=1,2,3,,m
 2: k,j:1,2,,m/kj, by (d-6) and (d-7), for each receiver position Ck, used as pole-points, compute all combinations of polar-points Pkj(xpkj,ypkj) and Qkj(xqkj,yqkj) with the respective receiver at position Cj and signal range rj.
 3: Stores the corresponding points Pkj and Qkj in the set R (RR{Pkj,Qkj}).
 4: For each corresponding Pkj and Qkj points, by (d-6), compute the pkj polar-line equation.
5: end for
6: For all pkj polar-lines, by (d-3), compute the intersections points, (x+,y+), among all others polar-lines. Stores these intersections points in S.
7: Apply (d-8), find the convex hull polygon for all polar-points in R. The obtained polygon is the minimal convex polygon that involves all interest points in R. This polygon constitutes our ROI.
8: Exclude from S all intersections points among all polar-lines on the boundary, or out, of the ROI, called bad intersections points.
9: Apply (d-9), compute the location estimation, Exy(Ex,Ey), of the emitter.
Information Output
10: Emitter location estimation Exy(Ex,Ey).

2.5. Tangent Lines Intersections Model (TLI)

Using each center circle point Ck as pole-point, one by one, all polar-points Pkj(xpkj,ypkj) and Qkj(xqkj,yqkj) can be computed for each other circle jk (Figure 1b, Figure 3 and Figure 10). It is possible to draw two lines for a particular Ck point (tangent lines to a circle jk): one passing through by Pkj and another by Qkj (Figure 10 and Figure 11a). If m is the number of receivers in the system (there are m circles), so, 2(m1) tangent lines (Figure 10 and Figure 11a) pass through each circle and generate a large set of intersections points among these lines, but most of these points are bad points that are eliminated by the convex hull ROI. The convex hull among polar-points establishes a ROI that ensures better symmetry among the points of interest. For large values of m, many intersections will occur very far from the ROI, breaking the desired symmetry among these points.

Figure 10.

Figure 10

Results produced by Tangent Lines Intersections (TLI) model. (a,b) show the possible presence of noise in acquired data. (c,d) represents the best case for acquired data. (d) Use of four receivers (the legend box is omitted for best view). For cases (c,d) is better applying the exact solution provided by Section 2.1.

Figure 11.

Figure 11

(a) Illustrations that define the Tangent Lines with Minimal Angles Model (MAI). (b) All intersections (red-star) with non-minimal angle tangent lines (orange-lines) must be eliminated. (c) All points inside the ROI formed by the convex hull polygon among the circle centers are the required points (blue-star).

There are intersections of tangent lines in each circle center because they pass by each circle center (receiver position) Ck. Whether these center points must be used in the estimation of emitter location depends on the geometric arrangement among receivers. While the results produced by TLI model (Algorithm 4) are consistent (Figure 10), m4 receiver usage is recommended (Figure 10d) for best accuracy.

Algorithm 4. TLI—Tangent Lines Intersections Model Algorithm
Data Input
m2 is the number of receivers.
Ck(xk,yk), k=1,2,,m, is the planar position of each receiver.
rk,k=1,2,,m, is the signal range of each receiver to an emitter.
Procedure
1: for each k=1,2,3,,m
 2: k,j:1,2,,m/kj, by (d-6) and (d-7), for each receiver position Ck, used as pole-points, compute all combinations of polar-points Pkj(xpkj,ypkj) and Qkj(xqkj,yqkj) with the respective receiver at position Cj and signal range rj.
 3: Stores the points Pkj and Qkj in the set R (RR{Pkj,Qkj}).
 4: For each corresponding Pkj and Qkj polar-points, by (d-6), computes the respective two tangent lines equation tPkj and tQkj that passes by each Ck.
5: end for
6: For all tPkj and tQkj tangent-lines, by (d-3), computes the intersections points, (x+,y+), among all tangent-lines. Store these intersections points in S.
7: Apply (d-8), find the convex hull polygon for all polar-points in R. The obtained polygon is the minimal convex polygon that involves all interest points in R. This polygon constitutes our ROI.
8: Exclude from S all intersections points among all tangent-lines on the boundary, or out, of the ROI, called bad intersections points.
9: Apply (d-9), compute the location estimation, Exy(Ex,Ey), of the emitter.
Information Output
10: Emitter location estimation Exy(Ex,Ey).

2.6. Tangent Lines with Minimal Angles Model (MAI)

A complementary explanation is necessary before presenting this model. We have to consider three disjoint circles centered at C0(x0,y0), C1(x1,y1), and C2(x2,y2), as Figure 11a shows. Two tangent lines pass by C0 through the circle at C1 and two more through to the circle at C2. Consider the angles θk, k=0,1,2,3, formed between two tangent line pairs that touch the circles at C1 and C2. The tangent lines that touch the same circle are not important to this analysis. Discard all combinations of tangent lines pairs that touch the same circle. For the illustration presented by Figure 11a, four angles can be obtained by combining all possible pairs of tangent lines that touch different pairs of circles.

For each circle pair, the two tangent lines that form the lowest angle must be preserved, while others must be removed. These two preserved lines are used by MAI (Algorithm 5). Figure 11a shows that the two lines combinations with lowest angle are the tangents lines t11 and t02. Repeat this process to obtain all combinations of Tangent Lines with Minimal Angle that pass by different circles center to other m1 circles for each different pair of circle. Executing this procedure, Figure 11b,c shows in orange-color the lines that must be eliminated.

Figure 12 and Figure 13 show some examples of results produced by applying the MAI. The results Figure 12a,b and Figure 13 are consistent with the expected results due to the signals range errors.

Figure 12.

Figure 12

Results produced by MAI model. (a,b) show the possible presence of noise in acquired data. (c,d) represents the best case for acquired data. (d) Application using four receivers (the legend box is omitted for best view). For the cases (c,d) is better applying the exact solution provided by Section 2.1.

Figure 13.

Figure 13

Geometric incoherence. The receiver is placed inside the range of another receiver. The geometric models TLI and MAI are able to overcome this data inconsistency and produce a satisfactory result.

The signal range used in Figure 12c,d are accurate and the solutions are exact. But, for Figure 12c the MAI do not found this exact solution. MAI did not find the exact solution because the geometric arrangement of the devices of the localization system is not symmetrical. In case Figure 12d there is this geometric symmetry and the exact solution was found. However, it can be seen both in Figure 12c,d that there are polar points marking the exact solution and, if the exact solution exists, the best way to find it is to apply the solution provided in Section 2.1 of this work.

Algorithm 5. MAI—Tangent Lines with Minimal Angles Intersections Model Algorithm
Data Input
m2 is the number of receivers.
Ck(xk,yk), k=1,2,,m, is the planar position of each receiver.
rk,k=1,2,,m, is the signal range of each receiver to an emitter.
Procedure
1: for each k=1,2,3,,m
 2: k,j:1,2,,m/kj, by (d-6) and (d-7), for each receiver position Ck, used as pole-points, compute all combinations of polar-points Pkj(xpkj,ypkj) and Qkj(xqkj,yqkj) with the respective receiver at position Cj and signal range rj.
 3: Stores the points Pkj and Qkj in the set R (RR{Pkj,Qkj}).
 4: For each corresponding Pkj and Qkj polar-points, by (d-6), compute the respective two tangent lines equation tPkj and tQkj that passes by Ck.
5: end for
6: For all tPkj and tQkj tangent-lines, by (d-3), compute the intersections points, (x+,y+), among all tangent-lines. Stores these intersections points in S.
7: Apply (d-8), find the convex hull polygon for all center circles points Ck. The obtained polygon is the minimal convex polygon that involves all interest points in S. This polygon constitutes our ROI.
8: Exclude from S all intersections points among all tangent-lines on the boundary, or out, of the ROI, called bad intersections points.
9: Apply (d-9), compute the location estimation, Exy(Ex,Ey), of the emitter.
Information Output
10: Emitter location estimation Exy(Ex,Ey).

3. Experimental Cases

3.1. Methodology Applied to Real Data Acquisition

In order to carry out our experiments, a structure composed of five APs devices to compose the emitters system (AP4, AP5, AP6, AP7, and AP8) is set up in an outdoor environment that covers an area of 150 m2 on the ground (Figure 14). Each AP is positioned at the Cartesian coordinate (x,y) and the respective value (in meters) is registered alongside the respective AP (e.g., the AP5 is at (9.60,2.84)Figure 14). These Cartesian coordinate (2D) design the set of Ck points (centers of range signals circles computed for the kth-AP) and defines the geometric arrangement of the covered area on the ground.

Figure 14.

Figure 14

Structure composed of five Access Point (AP) devices and their respective position on an outdoor environment.

An AP is the interface between wireless and wired section of the network. Its task is supported by the IEEE 802.11 Network Infrastructures and mainly consists in a translation of the frames from wireless framing format into a wired network framing format like Ethernet. This experiment uses the AP Tp-Link Wireless N 300 Mbps TL-WR849N to compose the system of emitters that emits signals of radio frequency of 2.4 GHz.

The receiver device is a commercial cell phone operating with the operational system Android. A previously developed application capable of receiving, identifying and measuring the strength of the signal sent by each emitter (APs of interest) was installed in this cell phone (our mobile device).

To calibrate the mobile device it is placed at a distance of one meter away from each AP to acquire the respective signal strength of reference (ρ0k) sent by the kth-AP.

Next, a set of coordinates Ep, marked and identified as known ground points, is located on the covered region. The mobile device is positioned on each of these marked ground points to receive the signals sent by each AP of interest. In this position, the strength of the signal ρk(d) sent by the kth-AP is measured by the mobile device application.

By means of Equation (6), the radial signal-range d=rkp is computed for each k-AP located at Ck using the signal strength ρkp sent by the respective k-AP and received by the mobile device located at Ep at each ground coordinate. The value =2.2 is adopted for the path-loss factor in order to use the Equation (6),

Thus, we know the position of each emitter k given by Ck(xk,yk); the radial signal-range at each AP given by rkp and; the real receiver position given by Ep(xp,yp) (Figure 15).

Figure 15.

Figure 15

Acquired data quality (graphical units in meter). (a,b) worst quality data. (c) Satisfactory data quality.

Now, through the proposed geometrical models, using Ck(xk,yk) and rk as input data, the location estimation Exy(Ex,Ey) of the receiver can be computed and the distance between this emitter location approximation Exy to its known (real) position Ep can be calculated.

The acquired data in this analysis cases are not preprocessed. Raw data are used to verify the behavior of the proposed geometric models in cases of works with data incoherency.

3.2. Quality of Acquired Data

Figure 15 shows three sets of acquired data quality. Figure 15a,b are poor data quality and Figure 15c shows satisfactory data quality. Figure 15a shows that AP6 and AP7 overestimate and AP4 e AP5 underestimate the respective radial signal range. Although AP8 is more specific, the incoherence of data diverts the solution from the desired precision, independent of the method used to formulate the estimation. In light of this, [27] provided an alternative to improve the quality of the acquired data, [28] discussed the limits of localization using signal strength by a comparative study and [29] performed sensor localization under limited measurement capabilities. References [15,30] confirm that an optimal solution involves high computational cost, but obtaining the optimal solution is not guaranteed. This is because the errors are not in the methods that perform the triangulation of the signal data. The errors are in the signal data.

With regard to the problem of localization in wireless sensor networks [31,32,33,34] presented alternative approaches and concerns regarding signal data behavior. To achieve better results, [34] preprocessed data after processing a set of partial results to decide which the best one was. As it can be noticed, acquiring accurate signal data is an arduous task. References [5,35] proposed methods for sampling signal data acquisition and discussed uncertainty and signal location. Besides, the environment is not predictable with multipath, fading, interference and shading effects [16].

In Figure 15a, AP6 generates a signal range that covers an area of ≈1200 m2 on the ground, while the area covered by the APs system is ≈150 m2 (Figure 14). Therefore, this data incoherence leads to solutions with larger errors.

3.3. Results and Analyses

Three experimental cases are chosen to show the results produced by the application of the proposed geometric models: (1) one that produces the worst result; (2) one that produces result with intermediate precision; and (3) one that generates more accurate result. The accuracy achieved in these cases is due solely to the quality of the data acquired. For more result, see Appendix A.

These analyses consider three metrics: (1) the error in distance measurement (Euclidean distance between the estimated location of the emitter Exy(Ex,Ey) and the real emitter position Ep(xp,yp)); (2) the error along x-axis given by |Exxp|; and (3) the error along y-axis given by |Eyyp|.

The nomenclature used on the graphics legend box is:

  • PPC—Polar Points Centroid Model (proposed).

  • CHC—Convex Hull Centroid Model (proposed).

  • PLI—Polar Lines Intersections Model (proposed).

  • TLI—Tangent Lines Intersections Model (proposed).

  • MAI—Tangent Lines with Minimal Angles Model (proposed).

  • NRm—Newton–Rapson Method (for comparison).

  • LSm—Least Square Method (for comparison).

  • WLSm—Weighted Least Square Method (for comparison).

For accomplishing the analyses, twelve experimental cases are generated (Figure 14) and the proposed geometric models (PPC, CHC, PLI, TLI, and MAI) are utilized in each acquired data set. We also use WLSm, NRm, and LSm methods to demonstrate the superior quality of the proposed geometric models. The metrics of analyses (distance error, x-axis error, and y-axis error) are computed for each result obtained from the geometric models and numerical methods. Figure 16 shows the magnitude of these errors for each experimental case. In these graphs, the 13th case represents the arithmetic mean of the magnitude errors for the respective metric and model/method.

Figure 16.

Figure 16

Magnitude error analyses.

Table 1 presents a global evaluation of the error values considering all experiments for each geometric model and numerical method. These values explain that some geometric model produce results with errors equivalent to those produced by numerical methods. MAI and TLI models promote larger errors on the x-axis, but smaller on the y-axis and distance (dist). They also promote smaller errors and produce smaller maximum errors, which show that MAI and TLI achieve better results when there is inconsistency in the data. CHC and PLI miss the least on the x-axis and get most significant result on the y-axis and distance. Errors committed by PPC are equivalent to those committed by numerical methods (WLSm, NRm, and LSm). We can observe that errors may be larger or smaller depending on the quality of the acquired data, but in the general context, geometric models present better results than numerical methods.

Table 1.

Magnitude of errors in the experimental cases.

Methods Magnitudes Errors (in Meters)
Minimum Error Maximum Error Mean Error
x-axis y-axis Distance x-axis y-axis Distance x-axis y-axis Distance
PPC * 0.4 0.2 2.7 15.5 12.5 15.7 4.2 4.4 6.9
CHC * 0.1 0.1 0.6 11.9 6.0 12.8 2.5 2.4 3.7
PLI * 0.1 0.1 0.7 12.8 15.9 16.3 2.4 3.8 5.0
MAI * 1.6 0.3 1.7 7.9 5.3 8.9 4.2 1.5 4.7
TLI * 2.3 0.3 2.3 8.3 3.9 9.2 4.1 1.3 4.4
NRm 0.1 1.1 1.3 14.7 12.2 15.2 2.8 5.1 6.5
LSm 0.3 1.2 1.8 14.1 22.5 23.7 3.6 6.4 7.9
WLSm 0.1 0.7 1.3 13.6 15.3 17.7 3.5 4.9 6.5

* Geometric Models proposed in this work.

Table 2 displays a global mean error committed by the geometric models against numerical methods. That is to say, these values are the result of minimizing the errors reached by solving the problem of signal location. Errors are not committed by methods, but they are present in data, as Figure 15 displays. Table 2 shows that the proposed geometric models can achieve better results than those achieved by numerical methods.

Table 2.

Global mean errors (Geometric Models × Numerical Methods).

Mean Errors (in Meters)
x-axis y-axis Distance
Geometric Models 3.7 2.9 5.3
NRm + LSm+ WLSm 3.5 4.1 6.0

Table 3 displays the variability of the errors committed by each method. The column Effective Variability of the Errors is the arithmetic mean of the standard deviation of the errors committed on the x-axis, y-axis and in distance by each method.

Table 3.

Standard deviation of the errors.

Methods Standard Deviation of the Errors Effective Variabilityof the Errors
x-axis y-axis Distance
PPC * 4.1 3.8 4.5 4.1
CHC * 3.1 2.1 3.4 2.9
PLI * 3.3 4.1 4.9 4.1
MAI * 2.5 1.6 2.6 2.2
TLI * 2.3 1.0 2.3 1.9
NRm 4.0 4.0 4.9 4.3
LSm 4.3 6.7 7.4 6.1
WLSm 4.2 4.3 5.5 4.7

* Geometric Models proposed in this work.

The Effective Variability of the Errors (Table 3) allows analyzing how a method is sensitive to the variation of data quality. In other words, this value is a metric to define how much a method can approach the exact solution when it operates on data with errors. The lower this value, the less sensitive is the method to the errors in the data and therefore has the ability to produce more accurate results. A simple analysis of the data in Table 3 shows that the proposed geometric models are more robust when they operate on data with errors than the traditional WLSm, NRm, and LSm methods. Among the geometric methods, the TLI has greater capacity to process data with errors.

In order to analyze these results in a particular context, Figure 15 prove that the fourth experiment is the worst case of acquired signal data, since it promotes bigger errors, both for the numerical methods and for the geometric models (Figure 17a). An intermediate result is achieved by the eleventh (Figure 17b) experiment and the best result is obtained in tenth (Figure 17c).

Figure 17.

Figure 17

Figure 17

Some particular experimental results. (a) The worst case. (b) An intermediate case. (c) The best case. The blue-dotted circle lines show the receivers/emitters that suffered severe interferences and promoted the acquisition of data with errors.

Figure 17c shows that when satisfactory data make all methods and models works with relative precision, whereas data incoherencies (dotted circle lines in Figure 17) make results divert of the expected solution, and Figure 17a–c confirms that the proposed geometric models point to a location closer to the exact position of the signal source than the numerical methods used and can better solve the existing problem of data inaccuracy.

The worst case, Figure 17a, deals with the case of inconsistency of acquired data. Even, if the use of such data does not show the precise location of the emitter, the results produced by the geometric models are consistent with the geometric arrangement among data. The solution is found on the region where most of signals range (circles) intersects. The solution is inaccurate because of the serious deviations in the acquired data. If data inconsistency is moderate (Figure 17b), the proposed geometric models generate higher quality results than those produced by numerical methods.

The Appendix A presents six other experimental results.

4. Conclusions

Our results show that there is a geometrical relationship between the emitter location and elements of pole-polar geometry. For this aim, we propose geometric models to solve a geometric problem: 2D location of a signal source and, if accurate data are available, an exact solution is found with cost O(n) (Section 2.1). If the data quality is satisfactory, the proposed models obtain the best estimative for the problem of locating the signal emitter source and are more robust when they operate on data with errors than the traditional WLSm, NRm, and LSm methods.

This work contributes to cope with the problem of applying 2D point location in a geometric relationship by reducing the number of arithmetic operations needed by the current conventional methods in use and the inherent propagation errors in the acquired data. The proposed geometric models have low computational cost O(nlogn). The obtained results are consistent even when there is incoherence in the data or when there is incoherence geometric in the arrangement of the receivers system.

When analyzing these results, we observe that the solutions given by the geometric models are located around the region of intersections of the radial signals ranges for all cases. Thus, a linear combination of all these solutions is also a solution. Consequently, we have computed the mean among the five solutions to derive this linear combination with no special motivation. This new solution minimizes the global error (Table 2).

Five geometric models have been presented and experimented with displayed solutions that are located around the region of intersection of the radial signals range for all cases. A comparison of results with numerical methods Weighted Least-Square, Least-Square, and Newton–Rapson has been carried out and results achieved by the proposed geometric models have improved, especially in cases of moderate data incoherence.

The proposed geometric models have the following limitations: (1) 2D solution (we are developing a 3D solution). (2) Proposed methods for estimating location require that the device to be located be inserted into the coverage area of the APs. We are developing a solution to this limitation in conjunction with the 3D solution. (3) APs may be arranged collinearly only for a few specific cases.

To develop this work we have built a simulator in MatLab code and used the implemented functions to construct a prototype that processes real data [36]. All code and data used are at anyone’s disposal. Go to www.coding2change.org/articles/GeometricModels.zip. Consult User’s Manual for more instructions.

Acknowledgments

Special thanks to the University of Seville—Spain and the State University of Maringá—Brazil.

Appendix A. Complementary Results

Figure A1.

Figure A1

Figure A1

Complementary experimental results.

Author Contributions

A.M. and A.P conceived, designed and performed the experiments; proposed the geometrical models; analyzed the data and results; developed the MatLab code; wrote the paper. M.E. and F.D. conceived the experiments; analyzed the results; provided mathematical contributions; wrote the paper; acted as peer reviewers.

Funding

This research has been supported by the Pololas project (TIN2016-76956-C3-2-R) of the Spanish Ministry of Economy and Competitiveness and by the particular research plan of the University of Seville (VPPI-US).

Conflicts of Interest

The authors declare no conflict of interest. The founding sponsors had no role in the design of the study; in the collection, analyses, or interpretation of data; in the writing of the manuscript, and in the decision to publish the results.

References

  • 1.Wang H., Gao Z., Guo Y., Huang Y. A Survey of Range-Based Localization Algorithms for Cognitive Radio Networks; Proceedings of the Second International Conference on Consumer Electronics, Communications and Networks; Yichang, China. 21–23 April 2012; pp. 844–847. [DOI] [Google Scholar]
  • 2.O’Hara B., Petrick A. The IEEE 802.11 Handbook: A Designers Companion. 2nd ed. IEEE Press; New York, NY, USA: 2005. [Google Scholar]
  • 3.Ahmad U., Gavrilov A.V., Lee S., Lee Y.-K. A modular classification model for received signal strength based location systems. Neurocomput. Lett. 2008;71:2657–2669. doi: 10.1016/j.neucom.2007.11.045. [DOI] [Google Scholar]
  • 4.Kaemarungsi K., Krishnamurthy P. Analysis of WLAN’s received signal strength indication for indoor location fingerprinting. Pervasive Mob. Comput. 2012;8:292–316. doi: 10.1016/j.pmcj.2011.09.003. [DOI] [Google Scholar]
  • 5.Balanis C.A., Polycarpou A.C. In: Antennas. Wiley Encyclopedia of Telecommunications. Proakis J.G., editor. John Wiley & Sons; New York, NY, USA: 2003. pp. 179–188. [Google Scholar]
  • 6.Goswami S. Indoor Location Technologies. Springer; Heidelberg, Germany: 2013. [Google Scholar]
  • 7.Acharya R. Understanding Satellite Navigation. Elsevier Inc.; Atlanta, GA, USA: 2014. Chapters 6–7. [DOI] [Google Scholar]
  • 8.Wu R.H., Lee Y.H., Tseng H.W., Jan Y.G., Chuang M.H. Study of characteristics of RSSI signal; Proceedings of the IEEE International Conference on Industrial Technology, ICIT 2008; Chengdu, China. 21–24 April 2008; [DOI] [Google Scholar]
  • 9.Fosdick L.D., Jessup E.R., Schauble C.J.C., Domik G. An Introduction to High-Performance Scientific Computing. The MIT Press; Cambridge, MA, USA: 1996. [Google Scholar]
  • 10.Bahl P., Padmanabhan V.N. RADAR: An in-building RF-based user location and tracking system. Proc. IEEE Infocom. 2000;2:775–784. [Google Scholar]
  • 11.Maass H. Location-Aware Mobile Applications based on Directory Services; Proceedings of the 3rd Annual ACM/IEEE International Conference on Mobile Computing and Networking, MobiCom ’97; Budapest, Hungary. 26–30 September 1997; pp. 23–33. [DOI] [Google Scholar]
  • 12.Nelson G.J. Ph.D. Thesis. University of Cambridge, Computer Lab; Cambridge, UK: Jan, 1998. Context-Aware and Location Systems. [Google Scholar]
  • 13.CISCO Wi-Fi Location-Based Services 4.1 Design Guide. [(accessed on 13 February 2018)];2014 Available online: http://www.cisco.com/c/en/us/td/docs/solutions/Enterprise/Mobility/WiFiLBS-DG.html.
  • 14.Mehra R., Singh A. Real Time RSSI Error Reduction in Distance Estimation Using RLS Algorithm; Proceedings of the IEEE 3rd International Advance Computing Conference, IACC 2013; Ghaziabad, India. 22–23 February 2013; pp. 661–665. [DOI] [Google Scholar]
  • 15.Luo M., Chen X., Cao S., Zhang X. Two New Shrinking-Circle Methods for Source Localization Based on TDoA Measurements. Sensors. 2018;18:1274. doi: 10.3390/s18041274. [DOI] [PMC free article] [PubMed] [Google Scholar]
  • 16.Beutel J. Location Management in Wireless Sensor Networks. In: Ilyas M., Mahgoub I., editors. Handbook of Sensors Networks: Compact Wireless and Wired Sensing Systems. CRC Press; New York, NY, USA: 2005. [Google Scholar]
  • 17.Tarrío P., Bernardos A.M., Casar J.R. Weighted Least Squares Techniques for Improved Received Signal Strength Based Localization. Sensors. 2011;11:8569–8592. doi: 10.3390/s110908569. [DOI] [PMC free article] [PubMed] [Google Scholar]
  • 18.Atkinson K.E. An Introduction to Numerical Analysis. 2nd ed. John Wiley & Sons; New York, NY, USA: 1988. [Google Scholar]
  • 19.Bancroft S. An algebraic solution of the GPS equations. IEEE Trans. Aerosp. Electron. Syst. 1985;AES-21:56–59. doi: 10.1109/TAES.1985.310538. [DOI] [Google Scholar]
  • 20.Strang G., Borre K. Linear Algebra, Geodesy, and GPS. Wellesley Press; Cambridge, UK: 1997. [Google Scholar]
  • 21.Rahman M.Z. In: Beyond Trilateration: GPS Positioning Geometry and Analytical Accuracy, Global Navigation Satellite Systems: Signal, Theory and Applications. Jin S., editor. InTechOpen; London, UK: 2012. [(accessed on 10 January 2018)]. pp. 241–256. Chapter 10. Available online: http://www.intechopen.com/books/global-navigation-satellite-systems-signal-theory-and-applications. [Google Scholar]
  • 22.WCIPEG—Programming Enrichment Group Computational Geometry. [(accessed on 13 February 2018)];Woburn Collegiate Institute’s. Available online: http://wcipeg.com/wiki/Computational_geometry.
  • 23.Gibson C.G. Elementary Euclidean Geometry: An Introduction. Cambridge University Press; Cambridge, UK: 2004. [Google Scholar]
  • 24.Knuth D.E. Axioms And Hulls: Lecture Notes in Computer Science. Springer; Heidelberg, Germany: 1992. [Google Scholar]
  • 25.Barber C.B., Dobkin D.P., Huhdanpaa H.T. The Quickhull Algorithm for Convex Hulls. ACM Trans. Math. Softw. 1996;22:469–483. doi: 10.1145/235815.235821. [DOI] [Google Scholar]
  • 26.O’Rourke J. Computational Geometry in C. 2nd ed. Cambridge University Press; Cambridge, UK: 1994. [Google Scholar]
  • 27.Halder S.J., Choi T.Y., Park J.H., Kang S.H., Park S.W., Park J.G. Enhanced ranging using adaptive filter of ZIGBEE RSSI and LQI measurement; Proceedings of the 10th International Conference on Information Integration and Web-Based Applications & Services, iiWAS ’08; Linz, Austria. 24–26 November 2008; pp. 367–373. [DOI] [Google Scholar]
  • 28.Elnahrawy E., Li X., Martin R.P. The limits of localization using signal strength: A comparative study; Proceedings of the Sensor and Ad Hoc Communications and Networks; Santa Clara, CA, USA. 4–7 October 2004; pp. 406–414. [Google Scholar]
  • 29.Wang C., Xiao L. Sensor Localization under Limited Measurement Capabilities. IEEE Netw. 2007;21:16–23. doi: 10.1109/MNET.2007.364254. [DOI] [Google Scholar]
  • 30.Mensing C., Plass S. Positioning algorithms for cellular networks using TDOA; Proceedings of the 2006 IEEE International Conference on Acoustics, Speech and Signal Processing; Toulouse, France. 14–19 May 2006; p. IV. [DOI] [Google Scholar]
  • 31.Wu D., Bao L., Li R. UWB-Based Localization in Wireless Sensor Networks. Int. J. Commun. Netw. Syst. Sci. 2009;2:407–442. doi: 10.4236/ijcns.2009.25046. [DOI] [Google Scholar]
  • 32.Sahoo P.K., Hwang I.-S. Collaborative Localization Algorithms for Wireless Sensor Networks with Reduced Localization Error. Sensors. 2011;11:9989–10009. doi: 10.3390/s111009989. [DOI] [PMC free article] [PubMed] [Google Scholar]
  • 33.Amitangshu P. Localization Algorithms in Wireless Sensor Networks: Current Approaches and Future Challenges. Netw. Protoc. Algorithms. 2010;2:45–73. doi: 10.5296/npa.v2i1.279. [DOI] [Google Scholar]
  • 34.Schneider C., Zutz S., Rehrl K., Brunaue R., Gröchenig S. Evaluating GPS sampling rates for pedestrian assistant. J. Locat. Based Serv. 2016;10:212–239. doi: 10.1080/17489725.2016.1259509. [DOI] [Google Scholar]
  • 35.Lam L.D.M., Tang A., Grundy J. Heuristics-based indoor positioning systems: A systematic literature review. J. Locat. Based Serv. 2016;10:212–239. doi: 10.1080/17489725.2016.1232842. [DOI] [Google Scholar]
  • 36.Montanha A., Escalona M.J., Domínguez-Mayo F.J., Polidorio A. Technological Innovation to Safely Aid in the Spatial Orientation of Blind People in a Complex Urban Environment; Proceedings of the International Conference on Image, Vision and Computing (ICIVC); Portsmouth, UK. 3–5 August 2016; New York, NY, USA: IEEE Publisher; 2016. pp. 102–107. [DOI] [Google Scholar]

Articles from Sensors (Basel, Switzerland) are provided here courtesy of Multidisciplinary Digital Publishing Institute (MDPI)

RESOURCES