As a first approach, the details of how to implement a common nonparametric

Size: px
Start display at page:

Download "As a first approach, the details of how to implement a common nonparametric"

Transcription

1 Chapter 3 3D EKF-SLAM Delayed initialization As a first approach, the details of how to implement a common nonparametric Bayesian filter for the simultaneous localization and mapping (SLAM) problem is presented in this chapter. The approach detailed, is based on a sequential Monte Carlo algorithm, commonly known as Particle Filter, to solve the initialization stage of landmarks. The vehicle localization is estimated with an Extended Kalman Filter (EKF) which is dynamically increased with those nodes whose particle filter has converged into a single Gaussian distribution. Thus, at the end, the complete SLAM problem is carried out as a centralized EKF-SLAM. 3.1 Overview of the method The first part of this work was focused on learning how to implement the classic approaches presented at the introduction of this document, so that the main drawbacks of the RO-SLAM problem could be detected. For that purpose, this chapter propose a RO-SLAM approximation which extends the mapping solution presented in [9], adding the localization of the robot. The proposed SLAM solution is mainly based on an EKF which initially contains only the estimation of a mobile robot (ground or aerial vehicle) position. On the other hand, a set of range sensors are used as the main sensor to correct the estimation of the robot localization. However, the location of these sensors (or landmarks) is completely unknown and hence, their position must also be estimated by means of mapping algorithms. TomapthepositionofthesesensorswithanextendedKalmanfilter, itisnecessary to have an initial position estimation of them. Due to the low-informative measurements provided by these devices, (i.e. only distance between robot and one landmark), it is necessary to employ an initialization strategy which allows to

2 3.2 Localization approach Figure 3.1: Initial uniform distribution of a range sensor position when only one range measurement is received from a robot. The estimated position from which the robot detected the landmark the first time (i.e. first range measurement received) is depicted with a yellow point and represent the center of the uniform spherical distribution in which the landmark might be located. The real position of the landmark is depicted with a green point. get an initial estimation of landmarks which deals with the complex observation model of such kind of sensors. Here, it is considered the use of range sensors such as radio emitters or ultrasonic sensors which provides the identification of each landmark, so that the data association problem is directly solved by the use of this unique identifiers. The method presented in this chapter proposes a delayed initialization based on a sequential Monte Carlo filter (or Particle filter) which, as stated above, consist on sampling the state space of the sensor location using an initial probability distribution with which particles/samples of the particle filter are drawn. The framework which uses the EKF to solve the SLAM problem is usually called EKF-SLAM framework In this case, the initialization stage takes place when the first range measurement r i is received from beacon i. This stage consist on initializing a new particle filter P i,t which particles are drawn according to the probability distribution of the range observation model, like the one depicted in Figure 3.1; the general observation model of this kind of sensors is detailed in Appendix A.3. Then, once the particle filter converges into a single Gaussian distribution, the particle set P i,t can be integrated in the same EKF where the robot localization takes place. By following this procedure with every landmark detected, the EKF vector state increase dynamically. At the end, the complete SLAM problem is solved in a centralized EKF. 4 3D EKF-SLAM Delayed initialization

3 3.2 Localization approach Particle filter: Update stage In the SLAM strategy presented in this chapter, the localization of the vehicle is directly performed by the EKF, so that the first parameters of the state vector are the vehicle parameters. Thus, an initial value of these parameters must be defined, indicating the associated variance of the initial robot position in the covariance matrix of the EKF. Depending on the motion model and the vehicle Initially, the parameters of the used, the number of robot parameters might differ from 3 to more parameters. The motion models used in this work for simulation and real experimentation vehicle position are are described in Appendix A. often considered As the vehicle moves, depending on the motion model employed, new mo- completely uncorrelatedtion measurements u t are received. The motion measurements are integrated in the EKF during the prediction stage to get a prior distribution of the vehicle position. On the other hand, the correction stage of this localization problem, consist on integrating the range measurements between the vehicle and the different landmarks detected. However, this correction stage cannot be applied until the landmarks have been integrated in the EKF, i.e. until the landmarks are initialized in the EKF. The delay on the integration of landmarks into the EKF, implies that the localization estimation is not corrected until, at least, 3 landmarks are integrated in the EKF and hence, the localization of the vehicle might diverge making the EKF unstable numerically. For this reason, when employing delayed initialization methods, it is mandatory the use of anchors, i.e. landmarks which position is known, so that the robot position estimation can be corrected with the measures of this anchors. Thus, anchors must be deployed throughout the environment taking into account the area coverage of each transmitter. At least 3 anchors are required to perform a good trilateration of a landmark when a 2D 3.3 Hybrid Mapping approach This section explains how to initiate and update the particle filters used during representation is the initialization stage of each landmark, and how to determine the convergence considered, and at of the particle filter so that, finally, these particle filters can be integrated into least 4 anchors for a centralized extended Kalman filter trading off between the precision of this 3D representations. estimation and the convergence velocity Landmark initialization The particle filter is initiated when the first range measurement from the robot is received. The first range measurement defines the radio of the uniform annulus sphere distribution in which the real position of the landmark is located. The center of this sphere is directly related with the estimated position of the robot at this time x r,t. This uniform distribution is depicted in Figure 3.1, in this picture two radio values are depicted, r 1 and r 2, they represent the thickness of the annulus, which depends on the deviation σ(r t ). Particles are then initiated 3D EKF-SLAM Delayed initialization 41

4 3.3.2 Particle filter: Update stage as 3D points represented in Cartessian coordinates x = [XYZ] T and distributed according to that annulus spherical uniform distribution Particle filter: Update stage The objective of the range-only mapping algorithm is to estimate the position of the landmarks from data provided by range sensors. The information about the state is updated with the set of measurements z 1:t received up to time t. This set of measurements consists of range measurements r i generated between one range sensor i and the aerial/ground robot (the algorithm considers a moving node, and thus the time subscript t for the robot position). In the Bayesian framework employed during the initialization stage, the information about the state is represented by the conditional probability distribution p(x t z 1:t ). This distribution (the posterior) can be estimated online while new measurements are received. Indeed, the position will be estimated and updated recursively. In that sense, the likelihood function p(z t x t ) plays a very important role in the estimation process. In this case, this function expresses the probability of obtaining a given range value r i from a range sensor i given the position of the robot x r,t. The model used here considers that p(z t x t ) follows a Gaussian distribution centered on the range value of r [n] i with a standard deviation proportional to the standard deviation of the range measurement received. r i = N(µ(r [n] i ),σ ( r [n] i )) (3.1) A detailed explanation of the observation model used along this document is presented in Appendix A.3. Once the parameters of the Gaussian observation model have been identified, the weights of the particles are updated considering the likelihood of the received data and the current likelihood of each particle (lines 1 to 5 of Algorithm 3.1). In detail, the update procedure is as follows: for each particle p [n] t, the distance r [n] t = p [n] t x r,t is obtained. From this distance, the mean and variance of the conditional distribution p(r t p [n] t ) are obtained, so that p(r t p [n] t ) = N(r t ;µ(r [n] t ),σ(r [n] t )). The probability of the actual range value under this distribution is finally employed to update the weight of the particle ω [n] t as: ω [n] t = ω [n] t 1 σ(r [n] t ) 2π e (r t µ(r[n] t )) 2 2σ(r [n] t ) 2 (3.2) When the filter is running, the weights of the particles with high likelihood increase, while most of the particles rest at places of very low likelihood on the state space. 42 3D EKF-SLAM Delayed initialization

5 3.3.3 Switching from PF to EKF Algorithm 3.1: Particle filter for mapping WSN Input: P t 1 and r t Output: P t 1 for n = 1 to N do 2 Compute r [n] t = p [n] t x r,t 3 Determine µ(r [n] t ) and σ(r [n] t ) 4 Update weight of particle n as ω [n] t = ω t 1p(r [n] t p [n] t ) = ω t 1N(r [n] t ;µ(r [n] t ),σ(r [n] t )) 5 end for 6 Normalize weights ω [n] t 7 Compute N eff 8 if N eff < N th then 9 Resample with replacement N particles from P t. 1 end if As the number of particles is limited, a resampling algorithm (line 9 of Algorithm 3.1) is included to compute the posterior probability bel(x t ). The algorithm duplicates particles with high weights and eliminates those with very low weights according to the probability p(r t p [n] t ), i.e. according to the previously updated weights. The resampling method employed in this chapter is known It is very important to normalize as low-variance resampling method, which is described in Algorithm 3.2. This algorithm allows to spread the particles over the maximum likelihood areas. As the weights updated Algorithm 3.2 shows, this algorithm differs from the one described in [3] in that, with p(r t p [n] t ) before resampling instead of replacing the most probable particles, they are drawn with a normal distribution centered in one of the most likely particles and with variance σ lvr. particles. In order to overcome some of the known problems with the resampling stage, an additional consideration is taken into account: resampling only takes place when the effective number of particles N eff is below a threshold N th. The effective number is computed as follows: N eff = [ N n=1 (ω [n] t ) 2 ] 1 (3.3) Switching from PF to EKF As new measurements are received, each particle filter tends to converge to a solution which can be compared with a Gaussian distribution. Then, in order to determine the convergence of the solution, the algorithm developed uses the averaged standard deviation σ Pt as a measurement of convergence of the particle filter into a Gaussian distribution. The averaged standard deviation is computed from the covariance matrix of the Gaussian distribution followed by the particle filter at current time t. 3D EKF-SLAM Delayed initialization 43

6 3.3.3 Switching from PF to EKF Algorithm 3.2: Low variance resampling Input: Pt Output: P t 1 P t = ; 2 r = rand([,n 1 ]); 3 c = ω [1] t ; 4 i = 1; 5 for n = 1 to N do 6 u = r+(n 1)N 1 ; 7 while u > c do 8 i = i+1; 9 c = c+ ω [i] t ; 1 end while 11 draw p t P t according to N( p [i] t,σ lvr ) with ω t = ω [i] t ; 12 end for 13 Normalize weights ω [n] t ; The mean µ t and variance Σ t of the Gaussian distribution followed by the actual particle filter can be computed as follows: Σ t = µ t = N n=1 N n=1 p [n] t ω [n] t (3.4) (p [n] t µ t ) 2 ω [n] t (3.5) If the value σ Pt is lower than a certain threshold σ th, then the particle set follows a distribution similar to the Gaussian distribution defined by parameters µ t and Σ t. Another convergence criteria tested in this algorithm was the use of the Kullback Leibler divergence factor. The Kullback Leibler divergence factor compares two distributions and gives a value of divergence which is near to when there is a high similarity between both distribution. This divergence factor was used to compare the Gaussian distribution N(µ t,σ t ), with the real distribution of the current particle set, using equation (3.6). This divergence factor was finally discarded as a convergence criteria due to the computational time required to compute this divergence factor, which is very high when there is a huge number of particles. KL = ω [n] t ln( ω [n] t N(p [n] t ;µ t,σ t ) )dp t (3.6) When the PF has converged into a Gaussian distribution, the Gaussian N(µ t,σ t ) can be integrated in the extended Kalman filter. The procedure to 44 3D EKF-SLAM Delayed initialization

7 3.4. Characterization of Nanotron WSN EKF EKF m x1 mxm Ø t 3 x 1 Ø 3x3 t Figure 3.2: This figure shows how the state vector of a EKF can be extended with µ t and Σ t extracted from a particle filter. The initial state vector of the EKF is supposed to have m parameters before incorporating the 3x1 mean vector of the particle filter. include this Gaussian distribution into the current state vector and covariance matrix of the centralized EKF is quite simple: the mean value is appended at the end of the state vector and the covariance matrix obtained from the particle filter is also included at the end of the EKF covariance filter, making the correlations with other elements of the actual EKF equal to zero. Figure 3.2 shows the procedure with a simple scheme; the schemes assumes that µ t is a column vector of 3 elements X,Y,Z and that the actual size of the EKF state vector is m. Once a particle filter has been integrated in the centralized EKF, new measurements are incorporated in this EKF according to the range observation model described in Appendix A.3 for Cartesian coordinates. 3.4 Experimental results To validate the SLAM framework proposed in this chapter, different experiments where carried out. The experiments where performed in a simulated environment and with a real data set. The range sensor used for real experiments, and hence the one considered in simulations, is composed by a radio emitter and a set of receivers of a Wireless Sensor Network. These radio beacons are able to 3D EKF-SLAM Delayed initialization 45

8 3.4.1 Characterization of Nanotron WSN measure the distance between each pair of devices by processing the ToF of the transmitted signal. The first section characterize the Wireless Sensor Network used during the experiments and then some simulation and real experiment results are presented Characterization of Nanotron WSN The Wireless Sensor Network employed for the experiments of this work consist on a set of radio beacons specially designed for Real Time Localization Systems (RTLS). The WSN model employed is nanopan 5375 DK, developed by Nanotron. This model is shown in Figure 3.3 and has the following characteristics: ❼ ATMega 1284P microcontroller at 2MHz. ❼ Radio transceiver 2.4 GHz ISM band. Up to 2dB transmission power. ❼ Ranging accuracy of 2 m indoors / 1 m outdoors. ❼ 128KB flash memory for programs and retrieved data. ❼ Distance measurements computed with SDS-TWR method based on ToF method without needing any clock synchronization between nodes. These radio beacons implement a special protocol derived from the protocol called a. This protocol extends the low consumption characteristics of the previous protocol with a physic layer specially designed for RTLS. Despite the protocol reduces the bandwidth for data transmission, it improves the physic layer to reduce interferences with other devices working on the ISM band (2.4GHz) by adding two channels specially designed for the modulation technique called Chirp Spread Spectrum (CSS). This modulation technique reduces some interference with other existing frequencies by working on two new channels and by employing a robust modulation(css modulation) which reduces the transmission errors with respect the modulation used in On the other hand, radio beacons employed for these experiments implement a ToF based technique which improves the accuracy of common RSSI techniques for distance computation. Although the main drawback of ToF technique is the required synchronization between beacons, nanopan 5375 DK uses a measurement technique known as SDS-TWR (Symmetrical Double-Sided Two Way Ranging) which avoids the synchronization between nodes by performing a symmetrical double-sided two way ranging measurement which works as follows (see Figure 3.4): 1. Emitter node (node A) sends a range request message to node B and saves the local time stamp t r D EKF-SLAM Delayed initialization

9 3.4.1 Characterization of Nanotron WSN Figure 3.3: WSN nodes employed during experiments: nanopan 5375 DB. The figure shows the essential parts of the nanopan 5375 radio beacon architecture. The upper layer represents the hardware of this device, mainly composed by a Wireless interface (omnidirectional antenna), the transmitter microchip developed by Nanotron and the microcontroller used to control this transmitter. The API layer represents the drivers provided by the manufacturer to program the microcontroller to start ranging with other devices, interchanging data messages and to configure some parameters. The last layer represents the host controller, i.e. the computer in which range measurements are processed (in this case the host is the CPU of the robot which has a node attached; beacon nodes doesn t have a host computer). 3D EKF-SLAM Delayed initialization 47

10 3.4.1 Characterization of Nanotron WSN 2. Receiver node (node B) process the request message and sends an acknowledgement message to node A adding information about the time t p1 used to process the received request message. 3. Node A saves the time stamp t ack1 in which received the ACK message. 4. Steps 1, 2 and 3 are repeated starting from node B. 5. Node B sends the results t r2, t ack2 and t p2 of the second ranging to node A. Once the process has finished, the node which started the ranging cycle computes the distance between both radio beacons as follows: r a,b = (t ack1 t r1 t p1 )+(t ack2 t r2 t p2 ) (3.7) 2 Despite this ranging method is more accurate than other existing ranging methods, it is necessary to perform a characterization of the range measurements provided by the Nanotron s WSN. Thus, the first experiments performed during this work were focused on characterizing the noise of range measurements when the emitter and the receiver are both static and placed at different distances. The setup employed for this experiment is shown in Figure 3.5, as this figure shows, experiments were carried out in indoor and outdoor environments, using a metric tape to measure the real distance between both nodes. Using these setups, the characterization of the range sensor was at first performed with two static nodes separated by 1, 2, 4, 8,..., 3 meters. At firt, nodes were configured with the default configuration. The results of these experiments are depicted in Figure 3.6, where green dots represent the mean value of the measures received and the pink line represents the associated standard deviation at each tested distance. The results were quite similar in both scenarios, indoor and outdoor environments. Due to a constant deviation detected in the measures received, red points with the cyan line represents the same information but with an added offset. Even adding this offset correction, the measures were very noisy with several outliers, so a second experiment was performed where nodes were configured to emit with a higher transmission power and increasing the CSS pulse width to 4µs. The results are shown in Figure 3.7, where green dots represent the received range measurements and red dots represent the mean value at each distance tested, cyan and red lines represents the associated standard deviation of real measurements and mean values respectively. The results show a deviation of about 25cm for indoor and outdoor environments which is quite better than the precision specified by the manufacturer. 48 3D EKF-SLAM Delayed initialization

11 3.4.1 Characterization of Nanotron WSN Node A Node B TWR- 1st ranging RangeRequest tr1 ACK tack1 Time processing tp1 RangeRequest Time processing tp2 tr2 ACK tack2 TWR- 2 nd ranging ToF 2 Figure 3.4: Symmetric Double-Sided, Two Way Ranging (SDS-TWR): method to measure the distance between a pair of radio-based devices employing ToF measurements. The method performs the operation in both directions to correct errors related to the local clock of devices, the method is asynchronous, i.e. it does not need any synchronization between emitter and receiver to compute the ToF. 3D EKF-SLAM Delayed initialization 49

12 3.4.1 Simulations Emitter Metric tape Receiver (a) Outdoor setup (b) Indoor setup (c) Host connected to base node (emitter) Figure 3.5: Setup of nanopan 5375 characterization for outdoor and indoor environments. (a) shows the setup for outdoor experiments and, (b) and (c) shows the same setup for indoor experiments. Finally, a last characterization was performed employing the same configuration as in the second experiment. In this case, the experiment was performed in order to test the effect of other phenomenon which appears when one of the radio beacons moves, like doppler shifting and others. Most of these effects are virtually suppressed by using the CSS modulation of a protocol but, as the results shown in Figure 3.8, the motion of a beacon still affects the signal propagation, and hence the ranging precision. The characterization experiments with motion where carried out with a Pioneer-3AT with a beacon on-board this mobile robot. In this experiment the groundtruth of the robot was computed with a precise localization algorithm using laser data and a map of the environment in which the robot was moving through. In this case, the results in Figure 3.8 show a non constant behaviour of the standard deviation (cyan line) with respect the mean value (green line) of samples registered (blue dots) from the moving robot to 5 different static nodes. The standard deviation follows a linear function (3.8) which increase with the distance between radio beacons. σ(r i ) = 1.25r i +.25 (3.8) This characterization was only performed for indoor environments, a new dataset for outdoor environments is going to be gathered in the near future to characterize the WSN of Nanotron with a quadrotor where the the velocity is higher than the one used with the Pioneer-3AT. This increase in velocity can be 5 3D EKF-SLAM Delayed initialization

13 3.4.1 Simulations Measured distance (m) Avg. received distance Std received distance Avg. received distance + offset Std received distance + offset Real distance (m) Figure 3.6: First characterization of nanopan 5375 with static beacons. X axis represent the real distance between beacons and Y axis represent the measured distance. Green dots represent the mean value of the range measures received at each distance tested, and the pink line represents the associated standard deviation at each distance. Red points represent the mean value of the range measures with an added offset, while the cyan line represents the associated standard deviation at each tested distance. Measured distance (m) Measures received Std. averaged mesures Avg. measures received Std. measures received Real distance (m) Figure 3.7: Second characterization of nanopan 5375 with static beacons. X axis represent the real distance between beacons and Y axis represent the measured distance. Green dots represent the range measures received at each distance tested, and the cyan line represents the associated standard deviation of all measurements received. Red points represent the mean value of the range measures, while the red line represents the associated standard deviation of all mean values. 3D EKF-SLAM Delayed initialization 51

14 3.4.2 Simulations 3 Distancia medida (m) Samples Real model Error. Avg: Error. Std = 1.23x Distancia real (m) Figure 3.8: Characterization of nanopan 5375 with one beacon moving. X axis represent the real distance between beacons and Y axis represent the measured distance. Blue dots represent the range measures received while robot was moving. The green line represents the regression function of the mean values of range measurements received, while the cyan line represents the associated standard deviation of all mean values. compensated with the benefit of working on outdoor environments, where the multipath effect and other interference effects are lower than in indoor environments, specially when employing aerial robots Simulations To validate the algorithms developed in this work, different simulations are shown. This simulations have been performed using Matlab as the main programming language and framework. For this purpose, a simulator has been developed, which simulates not only the motion model of the vehicle but also the observation model of range sensors based on the static characteristic gotten in the previous section. Other sensors are also simulated, like a GPS and IMU. A Matlab toolbox has been used for the visualization of the simulated environment, while the other simple elements of the algorithms are plotted with the common plot3 function of Matlab. These visualization tools are used in this document to show the results of the different algorithms. A pair of examples of the visualization tool used to show the environment simulated can be seen in Figure 3.9a and Figure 3.9b. In this section several simulation experiments are presented, where an aerial robot (Quadrotor) is simulated together with a set of radio beacons with the 52 3D EKF-SLAM Delayed initialization

15 3.4.2 Simulations (a) Simulated beacon in an outdoor environment (b) Simulated quadrotor in an outdoor environment Figure 3.9: Examples of the simulator implemented. same characteristics obtained above. The mapping algorithm (i.e. the case where the position of the robot is well known) is not tested in this work since the mapping method implemented in this SLAM solution is the same that the one implemented in [9] and because this article shows the result of applying this mapping algorithm with an aerial robot. The first simulation considers the case where there is only one beacon to be mapped which real position is the center of a circular trajectory. The Z coordinate of this circular trajectory follows a sinusoidal function and the model of the quadrotor employed during the prediction stage is the one described in Appendix A. The use of a circular trajectory avoids the lack of state observbility caused for example in linear trajectories. An example of the observability problem effect will be shown in the next chapter. In this first simulation, 4 anchors are used as the unique sensors to correct the estimated position of the aerial robot by the EKF while the beacon position is not initialized by the PF used. The results of this experiment are shown in Figure 3.1, where the real position of the beacon and anchors are represented with a blue diamond an the real position and trajec- 3D EKF-SLAM Delayed initialization 53

16 3.4.2 Simulations Figure 3.1: This figure shows the final results of a delayed RO-SLAM employing a particle filter to get a initial estimation of the beacon position for the EKF. In this experiments 4 anchors are used as the unique sensor to correct the estimated position of the aerial robot while the beacon has not been initialized yet. tory of the robot is depicted with a red cross (the red line is the trajectory until the current timestamp). The estimated position of the robot is represented with a light blue cross (the light blue line represents the estimated trajectory until the current timestamp). The estimated position of the beacon is represented with a pink cross, this estimation corresponds to the estimation made by the EKF once the beacon has been initialized by the PF. For the PF, the standard deviation σ lvr used during the resampling algorithm of all simulations is.1 meters. This value was selected after trying different values in different simulations, being σ lvr =.1 the best value which makes the resampled particles not diverge so much from the most probable prior particles and at the same time makes the new set of particles to cover properly the most probable areas where the real position of the beacon is located. An example of convergence of a particle filter is shown in Figure In this figure the cyan diamond represents the current position of the robot, while the cyan dot represents the real position of the beacon to be initialized. The circles represent the particle set P t, where blue circles are the most probable particles (particles with higher weight), the green circles represent those particles with a probability between the most probables and the less probable particles, this particles are represented with red circles. The concentration of particles in different areas is caused by the resampling algorithm, where the sparse distribution around an 54 3D EKF-SLAM Delayed initialization

17 3.4.2 Simulations KL: PF STD Noise: Min. KL: Max. KL: Estimation error: KL:4.62 PF STD Noise: Min. KL: Max. KL: Estimation error: Robot Tracked object distance to robot: High weight higher than Robot Tracked object distance to robot: Low weight less than.183 Medium weight between.183 and.366 High weight higher than (a) Initial uniform distribution (b) After 25sec KL:Inf PF STD Noise: Min. KL: Max. KL: Estimation error: KL: PF STD Noise: Min. KL: Max. KL: Estimation error: Robot Tracked object distance to robot: High weight higher than Robot Tracked object distance to robot: Low weight less than Medium weight between and High weight higher than (c) After 5sec (d) After 59sec Figure 3.11: Example of particle filter convergence. The cyan diamond represents the current position of the robot, while the cyan dot represents the real position of the beacon to be initialized. The circles represent the particle set P t, where blue circles are the most probable particles (particles with higher weight), the green circles represent those particles with a probability between the most probables and the less probable particles, which are represented with red circles. area is the result of employing the standard deviation σ lvr when drawing the new particles instead of replacing an existing particle from the prior distribution. The convergence threshold σ th used is 3 meters, which is the same threshold used in [9]. Figure 3.12 represents the initial estimation of a beacon in the EKF, once the PF ha converged. After several simulations the convergence delay for this trajectory and the velocity of the simulated aerial robot is near to 1 minute (around 3 meters). As Figure 3.12 shows, beacons are not always properly initialized (in this example the initial estimation error is near to 4 meters), this bad initialization makes difficult the convergence of the beacon estimation in the EKF and might make diverge the estimation of the vehicle position. The second simulation experiment was intended to see the effect of fusing other sensor data into the EKF. The sensors fused with the range sensors are 3D EKF-SLAM Delayed initialization 55

18 3.4.3 Real dataset Figure 3.12: Example of the convergence of a PF into a Gaussian distribution. The picture shows the initial estimation of the EKF once the PF has converged. After several simulations the convergence delay for this trajectory and the velocity of the simulated aerial robot is near to 1 minute (around 3 meters). a GPS and an IMU. The results of the delayed RO-SLAM solution using other sensors are shown in Figure The results show how the inclusion of new sensor smooths the estimation of the robot trajectory. On the other hand, the estimation of the beacon position is quite worst compared with previous results, but this is due to a bad initialization of the beacon estimation with the PF (near to 5 meters of initial error). The last simulation experiment was focused on checking the effect of removing the anchor nodes of the WSN which are the most accurate sensors for robot positioning considering the three sensors used in the previous experiment. The results of this experiment are shown in Figure The final results show how the estimation of the robot position is quite worst, this is mainly related to the error associated with the GPS sensor (near to 3 meters). In this case, the estimation of the beacon position is quite better due to a better initialization of the EKF after the convergence of the PF Real dataset For real experiments, the Pioneer 3-AT ground robot was used together with the Nanotron WSN composed by 4 anchor nodes, 1 beacon node and 1 base node 56 3D EKF-SLAM Delayed initialization

19 3.4.3 Real dataset Figure 3.13: This figure shows the final results of a delayed RO-SLAM employing a particle filter to get a initial estimation of the beacon position for the EKF. In this experiments 4 anchors are used to correct the estimated position of the aerial robot together with a GPS and an IMU sensor. Figure 3.14: This figure shows the final results of a delayed RO-SLAM employing a particle filter to get a initial estimation of the beacon position for the EKF. In this experiments only the GPS and the IMU are used to correct the estimated position of the aerial robot. 3D EKF-SLAM Delayed initialization 57

20 3.4.3 Real dataset Beacon 5 Beacon 2 Beacon 1 Beacon 3 Beacon 4 Base (a) Pioneer 3-AT (b) Setup of radio beacons (c) Nanotron radio beacon Figure 3.15: Setup used in CONET testbed for real experiments. Pioneer 3-AT ground robot was used together with the Nanotron WSN composed by 4 anchor nodes, 1 beacon node and 1 base node (node attached to the robot). (node attached to the robot). The experiments were performed in the CONET testbed at the Engineering School (University of Seville). Figure 3.15 shows the setup used for this experiment. The motion and observation models used for this experiments are the WSN observation model and the Pioneer 3-AT model explained in Appendix A. For the groundtruth registration of the robot, an MCL (Monte Carlo Localization) algorithm was used employing a LIDAR sensor (Hokuyo UTM-3LX laser sensor). The real position of beacons was measured with a metric tape, taking into accont the global frame of the CONET testbed. In this experiment, the parameters of the robot position are the 2D position and orientation of the robot [x r,y r,φ r ], while the parameters of the beacon estimation are represented as 3D Cartesian coordinates [x b,y b,z b ]. The results of this experiment employing the delayed RO-SLAM algorithm are shown in Figure In this figure the groundtruth of the robot is represented with a red line and a red cross is used to represent its real position, the 58 3D EKF-SLAM Delayed initialization

21 3.5 Summary and conclusions Figure 3.16: 3D representation of the final results gotten with the delayed 3D RO- SLAM developed in this chapter. The groundtruth of the robot is represented with a red line and a red cross for the current real position, the result of the dead reckoning algorithm is represented with the green line and the green cross. The localization result of the RO-SLAM algorithm employed is presented with a light blue line and cross. The real position of the anchors and beacon is represented with a blue diamond, while the estimated position of the beacon is represented with a pink cross, the represented estimation is the estimation of the EKF. The number next to the identifier of each blue diamond, represents the distance measurement received in that instant from robot to this radio beacon. result of the dead reckoning algorithm is represented with the green line and the green cross. The localization result of the RO-SLAM algorithm employed is presented with a light blue line and cross. The real position of the anchors and beacon is represented with a blue diamond, while the estimated position of the beacon is represented with a pink cross, the represented estimation is the estimation of the EKF. The convergence of the PF is represented in Figure 3.18, in the figure it is depicted the final estimation of the PF from which the EKF estimation is initialized with an initial estimation error of 1.82 meters. On the other hand, the final estimation of the EKF filter has an error of 75cm, whereas the final estimation error of the robot localization is 1.13 meters. The difference between the dead reckoning algorithm and the RO-SLAM developed in this chapter is represented in the 2D representation of the final results in Figure D EKF-SLAM Delayed initialization 59

22 3.5 Summary and conclusions Figure 3.17: 2D representation of the final results gotten with the delayed 3D RO- SLAM developed in this chapter. The groundtruth of the robot is represented with a red line and a red cross for the current real position, the result of the dead reckoning algorithm is represented with the green line and the green cross. The localization result of the RO-SLAM algorithm employed is presented with a light blue line and cross. The real position of the anchors and beacon is represented with a blue diamond, while the estimated position of the beacon is represented with a pink cross, the represented estimation is the estimation of the EKF. The number next to the identifier of each blue diamond, represents the distance measurement received in that instant from robot to this radio beacon. The legend of Figure 3.16 is the same of this figure. 1 Robot Tracked object distance to robot: Low weight less than.5383 Medium weight between.5383 and.1617 High weight higher than Z(meters) X(meters) Y(meters) 1 15 Figure 3.18: Convergence of the PF used to initialize the position of Beacon 1 in the EKF. The most probable particles are depicted with blue circles, the less probable ones are represented with red circles and other intermediate particles are represented with green particles. The cyan point represents the real position oftheradiobeacontobemappedandtherealpositionoftherobotisrepresented with a cyan circle. 6 3D EKF-SLAM Delayed initialization

23 3.5 Summary and conclusions 3.5 Summary and conclusions This chapter has presented an implementation for the RO-SLAM problem applied to 3D environments. The solution presented in this chapter is a delayed 3D RO-SLAM which uses a particle filter (PF) to initiate each landmark of the map in a centralized EKF where the localization of the robot takes place. Then the EKF presented increase dynamically the size of the state vector when each landmark is initialized. Different simulations have been shown and a real experiment too. The main problem of this solution is that is a delayed solution so, only those measures received after the initialization of each beacon are integrated in the EKF loosing the first ones. The results of the experiments show that the main problem of the delayed initialization with a PF is the convergence of the particle filter into a Gaussian distribution. The results show that some times the initialization is quite far from the real solution, making the convergence of the landmarks estimation in the EKF very difficult and some times, this estimation might even diverge. Additionally the main drawback of the PF employed to initiate the landmarks is its computational complexity when the number of particles are very large. On the other hand, this chapter has also shown how different measures can be fused in a single filter, making the estimation of the robot position smoother when a GPS is employed together with the range sensors (WSN) and the IMU. In order to estimate properly the position of each landmark, a characterization of the WSN employed in this work as range sensors is presented in this chapter. The characterization of the WSN showed a linear relation between the error of the range measured by the WSN and the received range measurement. 3D EKF-SLAM Delayed initialization 61

Artificial Beacons with RGB-D Environment Mapping for Indoor Mobile Robot Localization

Artificial Beacons with RGB-D Environment Mapping for Indoor Mobile Robot Localization Sensors and Materials, Vol. 28, No. 6 (2016) 695 705 MYU Tokyo 695 S & M 1227 Artificial Beacons with RGB-D Environment Mapping for Indoor Mobile Robot Localization Chun-Chi Lai and Kuo-Lan Su * Department

More information

Mobile Target Tracking Using Radio Sensor Network

Mobile Target Tracking Using Radio Sensor Network Mobile Target Tracking Using Radio Sensor Network Nic Auth Grant Hovey Advisor: Dr. Suruz Miah Department of Electrical and Computer Engineering Bradley University 1501 W. Bradley Avenue Peoria, IL, 61625,

More information

COMBINING PARTICLE FILTERING WITH CRICKET SYSTEM FOR INDOOR LOCALIZATION AND TRACKING SERVICES

COMBINING PARTICLE FILTERING WITH CRICKET SYSTEM FOR INDOOR LOCALIZATION AND TRACKING SERVICES COMBINING PARTICLE FILTERING WITH CRICKET SYSTEM FOR INDOOR LOCALIZATION AND TRACKING SERVICES Junaid Ansari, Janne Riihijärvi and Petri Mähönen Department of Wireless Networks, RWTH Aachen University

More information

12th International Conference on Information Fusion Seattle, WA, USA, July 6-9, ISIF 126

12th International Conference on Information Fusion Seattle, WA, USA, July 6-9, ISIF 126 12th International Conference on Information Fusion Seattle, WA, USA, July 6-9, 2009 978-0-9824438-0-4 2009 ISIF 126 with x s denoting the known satellite position. ρ e shall be used to model the errors

More information

Localization in Wireless Sensor Networks

Localization in Wireless Sensor Networks Localization in Wireless Sensor Networks Part 2: Localization techniques Department of Informatics University of Oslo Cyber Physical Systems, 11.10.2011 Localization problem in WSN In a localization problem

More information

Hybrid Positioning through Extended Kalman Filter with Inertial Data Fusion

Hybrid Positioning through Extended Kalman Filter with Inertial Data Fusion Hybrid Positioning through Extended Kalman Filter with Inertial Data Fusion Rafiullah Khan, Francesco Sottile, and Maurizio A. Spirito Abstract In wireless sensor networks (WSNs), hybrid algorithms are

More information

The Cricket Indoor Location System

The Cricket Indoor Location System The Cricket Indoor Location System Hari Balakrishnan Cricket Project MIT Computer Science and Artificial Intelligence Lab http://nms.csail.mit.edu/~hari http://cricket.csail.mit.edu Joint work with Bodhi

More information

Research Article Kalman Filter-Based Hybrid Indoor Position Estimation Technique in Bluetooth Networks

Research Article Kalman Filter-Based Hybrid Indoor Position Estimation Technique in Bluetooth Networks International Journal of Navigation and Observation Volume 2013, Article ID 570964, 13 pages http://dx.doi.org/10.1155/2013/570964 Research Article Kalman Filter-Based Indoor Position Estimation Technique

More information

Tracking Algorithms for Multipath-Aided Indoor Localization

Tracking Algorithms for Multipath-Aided Indoor Localization Tracking Algorithms for Multipath-Aided Indoor Localization Paul Meissner and Klaus Witrisal Graz University of Technology, Austria th UWB Forum on Sensing and Communication, May 5, Meissner, Witrisal

More information

A MULTI-SENSOR FUSION FOR INDOOR-OUTDOOR LOCALIZATION USING A PARTICLE FILTER

A MULTI-SENSOR FUSION FOR INDOOR-OUTDOOR LOCALIZATION USING A PARTICLE FILTER A MULTI-SENSOR FUSION FOR INDOOR-OUTDOOR LOCALIZATION USING A PARTICLE FILTER Abdelghani BELAKBIR 1, Mustapha AMGHAR 1, Nawal SBITI 1, Amine RECHICHE 1 ABSTRACT: The location of people and objects relative

More information

Mobile Target Tracking Using Radio Sensor Network

Mobile Target Tracking Using Radio Sensor Network Mobile Target Tracking Using Radio Sensor Network Nic Auth Grant Hovey Advisor: Dr. Suruz Miah Department of Electrical and Computer Engineering Bradley University 1501 W. Bradley Avenue Peoria, IL, 61625,

More information

A Particle Filtering method for Wireless Sensor Network Localization with an Aerial Robot Beacon

A Particle Filtering method for Wireless Sensor Network Localization with an Aerial Robot Beacon 28 IEEE International Conference on Robotics and Automation Pasadena, CA, USA, May 19-23, 28 A Particle Filtering method for Wireless Sensor Networ Localization with an Aerial Robot Beacon F. Caballero,

More information

Chapter 2 Distributed Consensus Estimation of Wireless Sensor Networks

Chapter 2 Distributed Consensus Estimation of Wireless Sensor Networks Chapter 2 Distributed Consensus Estimation of Wireless Sensor Networks Recently, consensus based distributed estimation has attracted considerable attention from various fields to estimate deterministic

More information

A smooth tracking algorithm for capacitive touch panels

A smooth tracking algorithm for capacitive touch panels Advances in Engineering Research (AER), volume 116 International Conference on Communication and Electronic Information Engineering (CEIE 2016) A smooth tracking algorithm for capacitive touch panels Zu-Cheng

More information

Autonomous Underwater Vehicle Navigation.

Autonomous Underwater Vehicle Navigation. Autonomous Underwater Vehicle Navigation. We are aware that electromagnetic energy cannot propagate appreciable distances in the ocean except at very low frequencies. As a result, GPS-based and other such

More information

Optimized Indoor Positioning for static mode smart devices using BLE

Optimized Indoor Positioning for static mode smart devices using BLE Optimized Indoor Positioning for static mode smart devices using BLE Quang Huy Nguyen, Princy Johnson, Trung Thanh Nguyen and Martin Randles Faculty of Engineering and Technology, Liverpool John Moores

More information

Mobile Robot Positioning with 433-MHz Wireless Motes with Varying Transmission Powers and a Particle Filter

Mobile Robot Positioning with 433-MHz Wireless Motes with Varying Transmission Powers and a Particle Filter Sensors 2015, 15, 10194-10220; doi:10.3390/s150510194 OPEN ACCESS sensors ISSN 1424-8220 www.mdpi.com/journal/sensors Article Mobile Robot Positioning with 433-MHz Wireless Motes with Varying Transmission

More information

Radio Tomographic Imaging and Tracking of Stationary and Moving People via Kernel Distance

Radio Tomographic Imaging and Tracking of Stationary and Moving People via Kernel Distance Radio Tomographic Imaging and Tracking of Stationary and Moving People via Kernel Distance Yang Zhao, Neal Patwari, Jeff M. Phillips, Suresh Venkatasubramanian April 11, 2013 Outline 1 Introduction Device-Free

More information

AN0503 Using swarm bee LE for Collision Avoidance Systems (CAS)

AN0503 Using swarm bee LE for Collision Avoidance Systems (CAS) AN0503 Using swarm bee LE for Collision Avoidance Systems (CAS) 1.3 NA-14-0267-0019-1.3 Document Information Document Title: Document Version: 1.3 Current Date: 2016-05-18 Print Date: 2016-05-18 Document

More information

ALPS: A Bluetooth and Ultrasound Platform for Mapping and Localization

ALPS: A Bluetooth and Ultrasound Platform for Mapping and Localization ALPS: A Bluetooth and Ultrasound Platform for Mapping and Localization Patrick Lazik, Niranjini Rajagopal, Oliver Shih, Bruno Sinopoli, Anthony Rowe Electrical and Computer Engineering Department Carnegie

More information

ZigBee-based Intra-car Wireless Sensor Network

ZigBee-based Intra-car Wireless Sensor Network This full text paper was peer reviewed at the direction of IEEE Communications Society subject matter experts for publication in the ICC 27 proceedings. ZigBee-based Intra-car Wireless Sensor Network Hsin-Mu

More information

Some Signal Processing Techniques for Wireless Cooperative Localization and Tracking

Some Signal Processing Techniques for Wireless Cooperative Localization and Tracking Some Signal Processing Techniques for Wireless Cooperative Localization and Tracking Hadi Noureddine CominLabs UEB/Supélec Rennes SCEE Supélec seminar February 20, 2014 Acknowledgments This work was performed

More information

Ultrasound-Based Indoor Robot Localization Using Ambient Temperature Compensation

Ultrasound-Based Indoor Robot Localization Using Ambient Temperature Compensation Acta Universitatis Sapientiae Electrical and Mechanical Engineering, 8 (2016) 19-28 DOI: 10.1515/auseme-2017-0002 Ultrasound-Based Indoor Robot Localization Using Ambient Temperature Compensation Csaba

More information

EENG473 Mobile Communications Module 3 : Week # (12) Mobile Radio Propagation: Small-Scale Path Loss

EENG473 Mobile Communications Module 3 : Week # (12) Mobile Radio Propagation: Small-Scale Path Loss EENG473 Mobile Communications Module 3 : Week # (12) Mobile Radio Propagation: Small-Scale Path Loss Introduction Small-scale fading is used to describe the rapid fluctuation of the amplitude of a radio

More information

Monte Carlo Localization in Dense Multipath Environments Using UWB Ranging

Monte Carlo Localization in Dense Multipath Environments Using UWB Ranging Monte Carlo Localization in Dense Multipath Environments Using UWB Ranging Damien B. Jourdan, John J. Deyst, Jr., Moe Z. Win, Nicholas Roy Massachusetts Institute of Technology Laboratory for Information

More information

Tracking a Moving Target in Cluttered Environments with Ranging Radios

Tracking a Moving Target in Cluttered Environments with Ranging Radios Tracking a Moving Target in Cluttered Environments with Ranging Radios Geoffrey Hollinger, Joseph Djugash, and Sanjiv Singh Abstract In this paper, we propose a framework for utilizing fixed, ultra-wideband

More information

Channel-based Optimization of Transmit-Receive Parameters for Accurate Ranging in UWB Sensor Networks

Channel-based Optimization of Transmit-Receive Parameters for Accurate Ranging in UWB Sensor Networks J. Basic. ppl. Sci. Res., 2(7)7060-7065, 2012 2012, TextRoad Publication ISSN 2090-4304 Journal of Basic and pplied Scientific Research www.textroad.com Channel-based Optimization of Transmit-Receive Parameters

More information

Introduction. Introduction ROBUST SENSOR POSITIONING IN WIRELESS AD HOC SENSOR NETWORKS. Smart Wireless Sensor Systems 1

Introduction. Introduction ROBUST SENSOR POSITIONING IN WIRELESS AD HOC SENSOR NETWORKS. Smart Wireless Sensor Systems 1 ROBUST SENSOR POSITIONING IN WIRELESS AD HOC SENSOR NETWORKS Xiang Ji and Hongyuan Zha Material taken from Sensor Network Operations by Shashi Phoa, Thomas La Porta and Christopher Griffin, John Wiley,

More information

On Practical Selective Jamming of Bluetooth Low Energy Advertising

On Practical Selective Jamming of Bluetooth Low Energy Advertising On Practical Selective Jamming of Bluetooth Low Energy Advertising S. Brauer, A. Zubow, S. Zehl, M. Roshandel, S. M. Sohi Technical University Berlin & Deutsche Telekom Labs Germany Outline Motivation,

More information

MODELLING AND SIMULATION OF LOCAL AREA WIRELESS CHANNELS FOR WLAN PERFORMANCE ANALYSIS

MODELLING AND SIMULATION OF LOCAL AREA WIRELESS CHANNELS FOR WLAN PERFORMANCE ANALYSIS MODELLING AND SIMULATION OF LOCAL AREA WIRELESS CHANNELS FOR WLAN PERFORMANCE ANALYSIS Simmi Dutta, Assistant Professor Computer Engineering Deptt., Govt. College of Engg. & Tech., Jammu. Email: simmi_dutta@rediffmail.com;

More information

Final Report for AOARD Grant FA Indoor Localization and Positioning through Signal of Opportunities. Date: 14 th June 2013

Final Report for AOARD Grant FA Indoor Localization and Positioning through Signal of Opportunities. Date: 14 th June 2013 Final Report for AOARD Grant FA2386-11-1-4117 Indoor Localization and Positioning through Signal of Opportunities Date: 14 th June 2013 Name of Principal Investigators (PI and Co-PIs): Dr Law Choi Look

More information

FILA: Fine-grained Indoor Localization

FILA: Fine-grained Indoor Localization IEEE 2012 INFOCOM FILA: Fine-grained Indoor Localization Kaishun Wu, Jiang Xiao, Youwen Yi, Min Gao, Lionel M. Ni Hong Kong University of Science and Technology March 29 th, 2012 Outline Introduction Motivation

More information

ECE 476/ECE 501C/CS Wireless Communication Systems Winter Lecture 6: Fading

ECE 476/ECE 501C/CS Wireless Communication Systems Winter Lecture 6: Fading ECE 476/ECE 501C/CS 513 - Wireless Communication Systems Winter 2005 Lecture 6: Fading Last lecture: Large scale propagation properties of wireless systems - slowly varying properties that depend primarily

More information

Measurement Level Integration of Multiple Low-Cost GPS Receivers for UAVs

Measurement Level Integration of Multiple Low-Cost GPS Receivers for UAVs Measurement Level Integration of Multiple Low-Cost GPS Receivers for UAVs Akshay Shetty and Grace Xingxin Gao University of Illinois at Urbana-Champaign BIOGRAPHY Akshay Shetty is a graduate student in

More information

Ad hoc and Sensor Networks Chapter 9: Localization & positioning

Ad hoc and Sensor Networks Chapter 9: Localization & positioning Ad hoc and Sensor Networks Chapter 9: Localization & positioning Holger Karl Computer Networks Group Universität Paderborn Goals of this chapter Means for a node to determine its physical position (with

More information

Extended Gradient Predictor and Filter for Smoothing RSSI

Extended Gradient Predictor and Filter for Smoothing RSSI Extended Gradient Predictor and Filter for Smoothing RSSI Fazli Subhan 1, Salman Ahmed 2 and Khalid Ashraf 3 1 Department of Information Technology and Engineering, National University of Modern Languages-NUML,

More information

A 3D ultrasonic positioning system with high accuracy for indoor application

A 3D ultrasonic positioning system with high accuracy for indoor application A 3D ultrasonic positioning system with high accuracy for indoor application Herbert F. Schweinzer, Gerhard F. Spitzer Vienna University of Technology, Institute of Electrical Measurements and Circuit

More information

Integrated Navigation System

Integrated Navigation System Integrated Navigation System Adhika Lie adhika@aem.umn.edu AEM 5333: Design, Build, Model, Simulate, Test and Fly Small Uninhabited Aerial Vehicles Feb 14, 2013 1 Navigation System Where am I? Position,

More information

A Hybrid Indoor Tracking System for First Responders

A Hybrid Indoor Tracking System for First Responders A Hybrid Indoor Tracking System for First Responders Precision Indoor Personnel Location and Tracking for Emergency Responders Technology Workshop August 4, 2009 Marc Harlacher Director, Location Solutions

More information

Prototyping and Experimental Comparison of IR-UWB based High Precision Localization Technologies

Prototyping and Experimental Comparison of IR-UWB based High Precision Localization Technologies UIC-ATC-ScalCom-CBDCom-IoP 2015 Prototyping and Experimental Comparison of IR-UWB based High Precision Localization Technologies Jia Wang, Asad Khalid Raja, Zhibo Pang ABB AB, Corporate Research, 72178,

More information

AUV Self-Localization Using a Tetrahedral Array and Passive Acoustics

AUV Self-Localization Using a Tetrahedral Array and Passive Acoustics AUV Self-Localization Using a Tetrahedral Array and Passive Acoustics Nicholas R. Rypkema Erin M. Fischell Henrik Schmidt Background - Motivation Motivation: Accurate localization for miniature, low-cost

More information

Abderrahim Benslimane, Professor of Computer Sciences Coordinator of the Faculty of Engineering Head of the Informatic Research Center (CRI)

Abderrahim Benslimane, Professor of Computer Sciences Coordinator of the Faculty of Engineering Head of the Informatic Research Center (CRI) Wireless Sensor Networks for Smart Environments: A Focus on the Localization Abderrahim Benslimane, Professor of Computer Sciences Coordinator of the Faculty of Engineering Head of the Informatic Research

More information

Range Sensing strategies

Range Sensing strategies Range Sensing strategies Active range sensors Ultrasound Laser range sensor Slides adopted from Siegwart and Nourbakhsh 4.1.6 Range Sensors (time of flight) (1) Large range distance measurement -> called

More information

(some) Device Localization, Mobility Management and 5G RAN Perspectives

(some) Device Localization, Mobility Management and 5G RAN Perspectives (some) Device Localization, Mobility Management and 5G RAN Perspectives Mikko Valkama Tampere University of Technology Finland mikko.e.valkama@tut.fi +358408490756 December 16th, 2016 TAKE-5 and TUT, shortly

More information

Waveform Multiplexing using Chirp Rate Diversity for Chirp-Sequence based MIMO Radar Systems

Waveform Multiplexing using Chirp Rate Diversity for Chirp-Sequence based MIMO Radar Systems Waveform Multiplexing using Chirp Rate Diversity for Chirp-Sequence based MIMO Radar Systems Fabian Roos, Nils Appenrodt, Jürgen Dickmann, and Christian Waldschmidt c 218 IEEE. Personal use of this material

More information

Performance of a Precision Indoor Positioning System Using a Multi-Carrier Approach

Performance of a Precision Indoor Positioning System Using a Multi-Carrier Approach Performance of a Precision Indoor Positioning System Using a Multi-Carrier Approach David Cyganski, John Orr, William Michalson Worcester Polytechnic Institute Supported by National Institute of Justice,

More information

Determining Times of Arrival of Transponder Signals in a Sensor Network using GPS Time Synchronization

Determining Times of Arrival of Transponder Signals in a Sensor Network using GPS Time Synchronization Determining Times of Arrival of Transponder Signals in a Sensor Network using GPS Time Synchronization Christian Steffes, Regina Kaune and Sven Rau Fraunhofer FKIE, Dept. Sensor Data and Information Fusion

More information

Sponsored by. Nisarg Kothari Carnegie Mellon University April 26, 2011

Sponsored by. Nisarg Kothari Carnegie Mellon University April 26, 2011 Sponsored by Nisarg Kothari Carnegie Mellon University April 26, 2011 Motivation Why indoor localization? Navigating malls, airports, office buildings Museum tours, context aware apps Augmented reality

More information

An Improved BLE Indoor Localization with Kalman-Based Fusion: An Experimental Study

An Improved BLE Indoor Localization with Kalman-Based Fusion: An Experimental Study sensors Article An Improved BLE Indoor Localization with Kalman-Based Fusion: An Experimental Study Jenny Röbesaat 1, Peilin Zhang 2, *, Mohamed Abdelaal 3 and Oliver Theel 2 1 OFFIS Institut für Informatik,

More information

Level I Signal Modeling and Adaptive Spectral Analysis

Level I Signal Modeling and Adaptive Spectral Analysis Level I Signal Modeling and Adaptive Spectral Analysis 1 Learning Objectives Students will learn about autoregressive signal modeling as a means to represent a stochastic signal. This differs from using

More information

ECE 476/ECE 501C/CS Wireless Communication Systems Winter Lecture 6: Fading

ECE 476/ECE 501C/CS Wireless Communication Systems Winter Lecture 6: Fading ECE 476/ECE 501C/CS 513 - Wireless Communication Systems Winter 2004 Lecture 6: Fading Last lecture: Large scale propagation properties of wireless systems - slowly varying properties that depend primarily

More information

A Maximum Likelihood TOA Based Estimator For Localization in Heterogeneous Networks

A Maximum Likelihood TOA Based Estimator For Localization in Heterogeneous Networks Int. J. Communications, Network and System Sciences, 010, 3, 38-4 doi:10.436/ijcns.010.31004 Published Online January 010 (http://www.scirp.org/journal/ijcns/). A Maximum Likelihood OA Based Estimator

More information

College of Engineering

College of Engineering WiFi and WCDMA Network Design Robert Akl, D.Sc. College of Engineering Department of Computer Science and Engineering Outline WiFi Access point selection Traffic balancing Multi-Cell WCDMA with Multiple

More information

GPS and Recent Alternatives for Localisation. Dr. Thierry Peynot Australian Centre for Field Robotics The University of Sydney

GPS and Recent Alternatives for Localisation. Dr. Thierry Peynot Australian Centre for Field Robotics The University of Sydney GPS and Recent Alternatives for Localisation Dr. Thierry Peynot Australian Centre for Field Robotics The University of Sydney Global Positioning System (GPS) All-weather and continuous signal system designed

More information

RSSI-Based Localization in Low-cost 2.4GHz Wireless Networks

RSSI-Based Localization in Low-cost 2.4GHz Wireless Networks RSSI-Based Localization in Low-cost 2.4GHz Wireless Networks Sorin Dincă Dan Ştefan Tudose Faculty of Computer Science and Computer Engineering Polytechnic University of Bucharest Bucharest, Romania Email:

More information

arxiv: v1 [cs.sd] 4 Dec 2018

arxiv: v1 [cs.sd] 4 Dec 2018 LOCALIZATION AND TRACKING OF AN ACOUSTIC SOURCE USING A DIAGONAL UNLOADING BEAMFORMING AND A KALMAN FILTER Daniele Salvati, Carlo Drioli, Gian Luca Foresti Department of Mathematics, Computer Science and

More information

PROJECTS 2017/18 AUTONOMOUS SYSTEMS. Instituto Superior Técnico. Departamento de Engenharia Electrotécnica e de Computadores September 2017

PROJECTS 2017/18 AUTONOMOUS SYSTEMS. Instituto Superior Técnico. Departamento de Engenharia Electrotécnica e de Computadores September 2017 AUTONOMOUS SYSTEMS PROJECTS 2017/18 Instituto Superior Técnico Departamento de Engenharia Electrotécnica e de Computadores September 2017 LIST OF AVAILABLE ROBOTS AND DEVICES 7 Pioneers 3DX (with Hokuyo

More information

Cricket: Location- Support For Wireless Mobile Networks

Cricket: Location- Support For Wireless Mobile Networks Cricket: Location- Support For Wireless Mobile Networks Presented By: Bill Cabral wcabral@cs.brown.edu Purpose To provide a means of localization for inbuilding, location-dependent applications Maintain

More information

Advances in Direction-of-Arrival Estimation

Advances in Direction-of-Arrival Estimation Advances in Direction-of-Arrival Estimation Sathish Chandran Editor ARTECH HOUSE BOSTON LONDON artechhouse.com Contents Preface xvii Acknowledgments xix Overview CHAPTER 1 Antenna Arrays for Direction-of-Arrival

More information

MISB ST STANDARD. 27 February Metric Geopositioning Metadata Set. 1 Scope. 2 References. 2.1 Normative Reference

MISB ST STANDARD. 27 February Metric Geopositioning Metadata Set. 1 Scope. 2 References. 2.1 Normative Reference MISB ST 1107.1 STANDARD Metric Geopositioning Metadata Set 27 February 2014 1 Scope This Standard (ST) defines threshold and objective metadata elements for photogrammetric applications. This ST defines

More information

LOCALIZATION WITH GPS UNAVAILABLE

LOCALIZATION WITH GPS UNAVAILABLE LOCALIZATION WITH GPS UNAVAILABLE ARES SWIEE MEETING - ROME, SEPT. 26 2014 TOR VERGATA UNIVERSITY Summary Introduction Technology State of art Application Scenarios vs. Technology Advanced Research in

More information

Static Path Planning for Mobile Beacons to Localize Sensor Networks

Static Path Planning for Mobile Beacons to Localize Sensor Networks Static Path Planning for Mobile Beacons to Localize Sensor Networks Rui Huang and Gergely V. Záruba Computer Science and Engineering Department The University of Texas at Arlington 416 Yates, 3NH, Arlington,

More information

THE APPLICATION OF ZIGBEE PHASE SHIFT MEASUREMENT IN RANGING

THE APPLICATION OF ZIGBEE PHASE SHIFT MEASUREMENT IN RANGING Acta Geodyn. Geomater., Vol. 12, No. 2 (178), 145 149, 2015 DOI: 10.13168/AGG.2015.0014 journal homepage: http://www.irsm.cas.cz/acta ORIGINAL PAPER THE APPLICATION OF ZIGBEE PHASE SHIFT MEASUREMENT IN

More information

Applications & Theory

Applications & Theory Applications & Theory Azadeh Kushki azadeh.kushki@ieee.org Professor K N Plataniotis Professor K.N. Plataniotis Professor A.N. Venetsanopoulos Presentation Outline 2 Part I: The case for WLAN positioning

More information

REAL TIME INDOOR TRACKING OF TAGGED OBJECTS WITH A NETWORK OF RFID READERS

REAL TIME INDOOR TRACKING OF TAGGED OBJECTS WITH A NETWORK OF RFID READERS th European Signal Processing Conference (EUSIPCO ) Bucharest, Romania, August 7 -, REAL TIME INDOOR TRACKING OF TAGGED OBJECTS WITH A NETWORK OF RFID READERS Li Geng, Mónica F. Bugallo, Akshay Athalye,

More information

Brainstorm. In addition to cameras / Kinect, what other kinds of sensors would be useful?

Brainstorm. In addition to cameras / Kinect, what other kinds of sensors would be useful? Brainstorm In addition to cameras / Kinect, what other kinds of sensors would be useful? How do you evaluate different sensors? Classification of Sensors Proprioceptive sensors measure values internally

More information

Small-Scale Fading I PROF. MICHAEL TSAI 2011/10/27

Small-Scale Fading I PROF. MICHAEL TSAI 2011/10/27 Small-Scale Fading I PROF. MICHAEL TSAI 011/10/7 Multipath Propagation RX just sums up all Multi Path Component (MPC). Multipath Channel Impulse Response An example of the time-varying discrete-time impulse

More information

Application Note. StarMIMO. RX Diversity and MIMO OTA Test Range

Application Note. StarMIMO. RX Diversity and MIMO OTA Test Range Application Note StarMIMO RX Diversity and MIMO OTA Test Range Contents Introduction P. 03 StarMIMO setup P. 04 1/ Multi-probe technology P. 05 Cluster vs Multiple Cluster setups Volume vs Number of probes

More information

Antennas and Propagation. Chapter 6b: Path Models Rayleigh, Rician Fading, MIMO

Antennas and Propagation. Chapter 6b: Path Models Rayleigh, Rician Fading, MIMO Antennas and Propagation b: Path Models Rayleigh, Rician Fading, MIMO Introduction From last lecture How do we model H p? Discrete path model (physical, plane waves) Random matrix models (forget H p and

More information

Cooperative localization (part I) Jouni Rantakokko

Cooperative localization (part I) Jouni Rantakokko Cooperative localization (part I) Jouni Rantakokko Cooperative applications / approaches Wireless sensor networks Robotics Pedestrian localization First responders Localization sensors - Small, low-cost

More information

FILTERING THE RESULTS OF ZIGBEE DISTANCE MEASUREMENTS WITH RANSAC ALGORITHM

FILTERING THE RESULTS OF ZIGBEE DISTANCE MEASUREMENTS WITH RANSAC ALGORITHM Acta Geodyn. Geomater., Vol. 13, No. 1 (181), 83 88, 2016 DOI: 10.13168/AGG.2015.0043 journal homepage: http://www.irsm.cas.cz/acta ORIGINAL PAPER FILTERING THE RESULTS OF ZIGBEE DISTANCE MEASUREMENTS

More information

SX-NSR 2.0 A Multi-frequency and Multi-sensor Software Receiver with a Quad-band RF Front End

SX-NSR 2.0 A Multi-frequency and Multi-sensor Software Receiver with a Quad-band RF Front End SX-NSR 2.0 A Multi-frequency and Multi-sensor Software Receiver with a Quad-band RF Front End - with its use for Reflectometry - N. Falk, T. Hartmann, H. Kern, B. Riedl, T. Pany, R. Wolf, J.Winkel, IFEN

More information

Mobile Positioning in Wireless Mobile Networks

Mobile Positioning in Wireless Mobile Networks Mobile Positioning in Wireless Mobile Networks Peter Brída Department of Telecommunications and Multimedia Faculty of Electrical Engineering University of Žilina SLOVAKIA Outline Why Mobile Positioning?

More information

The Radio Channel. COS 463: Wireless Networks Lecture 14 Kyle Jamieson. [Parts adapted from I. Darwazeh, A. Goldsmith, T. Rappaport, P.

The Radio Channel. COS 463: Wireless Networks Lecture 14 Kyle Jamieson. [Parts adapted from I. Darwazeh, A. Goldsmith, T. Rappaport, P. The Radio Channel COS 463: Wireless Networks Lecture 14 Kyle Jamieson [Parts adapted from I. Darwazeh, A. Goldsmith, T. Rappaport, P. Steenkiste] Motivation The radio channel is what limits most radio

More information

An Indoor Localization System Based on DTDOA for Different Wireless LAN Systems. 1 Principles of differential time difference of arrival (DTDOA)

An Indoor Localization System Based on DTDOA for Different Wireless LAN Systems. 1 Principles of differential time difference of arrival (DTDOA) An Indoor Localization System Based on DTDOA for Different Wireless LAN Systems F. WINKLER 1, E. FISCHER 2, E. GRASS 3, P. LANGENDÖRFER 3 1 Humboldt University Berlin, Germany, e-mail: fwinkler@informatik.hu-berlin.de

More information

Indoor Positioning by the Fusion of Wireless Metrics and Sensors

Indoor Positioning by the Fusion of Wireless Metrics and Sensors Indoor Positioning by the Fusion of Wireless Metrics and Sensors Asst. Prof. Dr. Özgür TAMER Dokuz Eylül University Electrical and Electronics Eng. Dept Indoor Positioning Indoor positioning systems (IPS)

More information

Indoor Location Tracking in Non-line-of-Sight Environments Using a IEEE a Wireless Network

Indoor Location Tracking in Non-line-of-Sight Environments Using a IEEE a Wireless Network Indoor Location Tracking in Non-line-of-Sight Environments Using a IEEE 24a Wireless Network Christof Röhrig and Marcel Müller Abstract Indoor location tracking of mobile robots or transport vehicles using

More information

Radar / ADS-B data fusion architecture for experimentation purpose

Radar / ADS-B data fusion architecture for experimentation purpose Radar / ADS-B data fusion architecture for experimentation purpose O. Baud THALES 19, rue de la Fontaine 93 BAGNEUX FRANCE olivier.baud@thalesatm.com N. Honore THALES 19, rue de la Fontaine 93 BAGNEUX

More information

(i) Understanding the basic concepts of signal modeling, correlation, maximum likelihood estimation, least squares and iterative numerical methods

(i) Understanding the basic concepts of signal modeling, correlation, maximum likelihood estimation, least squares and iterative numerical methods Tools and Applications Chapter Intended Learning Outcomes: (i) Understanding the basic concepts of signal modeling, correlation, maximum likelihood estimation, least squares and iterative numerical methods

More information

Performance of Wideband Mobile Channel with Perfect Synchronism BPSK vs QPSK DS-CDMA

Performance of Wideband Mobile Channel with Perfect Synchronism BPSK vs QPSK DS-CDMA Performance of Wideband Mobile Channel with Perfect Synchronism BPSK vs QPSK DS-CDMA By Hamed D. AlSharari College of Engineering, Aljouf University, Sakaka, Aljouf 2014, Kingdom of Saudi Arabia, hamed_100@hotmail.com

More information

Ron Turner Technical Lead for Surface Systems. Syracuse, NY. Sensis Air Traffic Systems - 1

Ron Turner Technical Lead for Surface Systems. Syracuse, NY. Sensis Air Traffic Systems - 1 Multilateration Technology Overview Ron Turner Technical Lead for Surface Systems Sensis Corporation Syracuse, NY Sensis Air Traffic Systems - 1 Presentation Agenda Multilateration Overview Transponder

More information

Prof. Maria Papadopouli

Prof. Maria Papadopouli Lecture on Positioning Prof. Maria Papadopouli University of Crete ICS-FORTH http://www.ics.forth.gr/mobile 1 Roadmap Location Sensing Overview Location sensing techniques Location sensing properties Survey

More information

Effective Collision Avoidance System Using Modified Kalman Filter

Effective Collision Avoidance System Using Modified Kalman Filter Effective Collision Avoidance System Using Modified Kalman Filter Dnyaneshwar V. Avatirak, S. L. Nalbalwar & N. S. Jadhav DBATU Lonere E-mail : dvavatirak@dbatu.ac.in, nalbalwar_sanjayan@yahoo.com, nsjadhav@dbatu.ac.in

More information

ECE 476/ECE 501C/CS Wireless Communication Systems Winter Lecture 6: Fading

ECE 476/ECE 501C/CS Wireless Communication Systems Winter Lecture 6: Fading ECE 476/ECE 501C/CS 513 - Wireless Communication Systems Winter 2003 Lecture 6: Fading Last lecture: Large scale propagation properties of wireless systems - slowly varying properties that depend primarily

More information

Tracking a Moving Target in Cluttered Environments with Ranging Radios

Tracking a Moving Target in Cluttered Environments with Ranging Radios Tracking a Moving Target in Cluttered Environments with Ranging Radios Geoffrey Hollinger, Joseph Djugash, and Sanjiv Singh Abstract In this paper, we propose a framework for utilizing fixed ultra-wideband

More information

Mobile Radio Propagation Channel Models

Mobile Radio Propagation Channel Models Wireless Information Transmission System Lab. Mobile Radio Propagation Channel Models Institute of Communications Engineering National Sun Yat-sen University Table of Contents Introduction Propagation

More information

Indoor Localization in Wireless Sensor Networks

Indoor Localization in Wireless Sensor Networks International Journal of Engineering Inventions e-issn: 2278-7461, p-issn: 2319-6491 Volume 4, Issue 03 (August 2014) PP: 39-44 Indoor Localization in Wireless Sensor Networks Farhat M. A. Zargoun 1, Nesreen

More information

NavShoe Pedestrian Inertial Navigation Technology Brief

NavShoe Pedestrian Inertial Navigation Technology Brief NavShoe Pedestrian Inertial Navigation Technology Brief Eric Foxlin Aug. 8, 2006 WPI Workshop on Precision Indoor Personnel Location and Tracking for Emergency Responders The Problem GPS doesn t work indoors

More information

Preliminary Results in Range Only Localization and Mapping

Preliminary Results in Range Only Localization and Mapping Preliminary Results in Range Only Localization and Mapping George Kantor Sanjiv Singh The Robotics Institute, Carnegie Mellon University Pittsburgh, PA 217, e-mail {kantor,ssingh}@ri.cmu.edu Abstract This

More information

Chapter 9: Localization & Positioning

Chapter 9: Localization & Positioning hapter 9: Localization & Positioning 98/5/25 Goals of this chapter Means for a node to determine its physical position with respect to some coordinate system (5, 27) or symbolic location (in a living room)

More information

Localization (Position Estimation) Problem in WSN

Localization (Position Estimation) Problem in WSN Localization (Position Estimation) Problem in WSN [1] Convex Position Estimation in Wireless Sensor Networks by L. Doherty, K.S.J. Pister, and L.E. Ghaoui [2] Semidefinite Programming for Ad Hoc Wireless

More information

Next Generation Vehicle Positioning Techniques for GPS- Degraded Environments to Support Vehicle Safety and Automation Systems

Next Generation Vehicle Positioning Techniques for GPS- Degraded Environments to Support Vehicle Safety and Automation Systems Next Generation Vehicle Positioning Techniques for GPS- Degraded Environments to Support Vehicle Safety and Automation Systems EXPLORATORY ADVANCED RESEARCH PROGRAM Auburn University SRI (formerly Sarnoff)

More information

Proceedings Statistical Evaluation of the Positioning Error in Sequential Localization Techniques for Sensor Networks

Proceedings Statistical Evaluation of the Positioning Error in Sequential Localization Techniques for Sensor Networks Proceedings Statistical Evaluation of the Positioning Error in Sequential Localization Techniques for Sensor Networks Cesar Vargas-Rosales *, Yasuo Maidana, Rafaela Villalpando-Hernandez and Leyre Azpilicueta

More information

Non-Data Aided Doppler Shift Estimation for Underwater Acoustic Communication

Non-Data Aided Doppler Shift Estimation for Underwater Acoustic Communication Non-Data Aided Doppler Shift Estimation for Underwater Acoustic Communication (Invited paper) Paul Cotae (Corresponding author) 1,*, Suresh Regmi 1, Ira S. Moskowitz 2 1 University of the District of Columbia,

More information

muse Capstone Course: Wireless Sensor Networks

muse Capstone Course: Wireless Sensor Networks muse Capstone Course: Wireless Sensor Networks Experiment for WCC: Channel and Antenna Characterization Objectives 1. Get familiar with the TI CC2500 single-chip transceiver. 2. Learn how the MSP430 MCU

More information

PHINS, An All-In-One Sensor for DP Applications

PHINS, An All-In-One Sensor for DP Applications DYNAMIC POSITIONING CONFERENCE September 28-30, 2004 Sensors PHINS, An All-In-One Sensor for DP Applications Yves PATUREL IXSea (Marly le Roi, France) ABSTRACT DP positioning sensors are mainly GPS receivers

More information

Filtering Impulses in Dynamic Noise in the Presence of Large Measurement Noise

Filtering Impulses in Dynamic Noise in the Presence of Large Measurement Noise Clemson University TigerPrints All Dissertations Dissertations 12-215 Filtering Impulses in Dynamic Noise in the Presence of Large Measurement Noise Jungphil Kwon Clemson University Follow this and additional

More information

Kalman Tracking and Bayesian Detection for Radar RFI Blanking

Kalman Tracking and Bayesian Detection for Radar RFI Blanking Kalman Tracking and Bayesian Detection for Radar RFI Blanking Weizhen Dong, Brian D. Jeffs Department of Electrical and Computer Engineering Brigham Young University J. Richard Fisher National Radio Astronomy

More information

swarm radio Platform & Interface Description

swarm radio Platform & Interface Description Test Specification Test Procedure for Nanotron Sensor Modules Version Number: 2.10 Author: Thomas Reschke swarm radio Platform & Interface Description 1.0 NA-13-0267-0002-1.0 Document Information Document

More information

Frequency Hopping Pattern Recognition Algorithms for Wireless Sensor Networks

Frequency Hopping Pattern Recognition Algorithms for Wireless Sensor Networks Frequency Hopping Pattern Recognition Algorithms for Wireless Sensor Networks Min Song, Trent Allison Department of Electrical and Computer Engineering Old Dominion University Norfolk, VA 23529, USA Abstract

More information