EKF Localization and EKF SLAM incorporating prior information

Size: px
Start display at page:

Download "EKF Localization and EKF SLAM incorporating prior information"

Transcription

1 EKF Localization and EKF SLAM incorporating prior information Final Report ME- Samuel Castaneda ID:

2 1. Abstract In the context of mobile robotics, before any motion planning or navigation algorithm can be executed, it is necessary for the robot to have a globally consistent map of the environment and its own location in it. The problem of simultaneously learning the global map and the location of the robot is commonly known as the Simultaneous Localization and Mapping (SLAM) problem. One important result about most SLAM problems is that since objects in the map have unknown positions, seen a new object doesn t help the robot to get a better estimate of its position nor the other objects poses. It s not until the robot sees a previously known landmark the loop can be closed and the estimation can really be accurate (achieve global consistency). A novel SLAM approach was presented in [1] to achieve global consistency by utilizing information extracted from aerial images of the environment as prior information to the SLAM problem. In this work, the SLAM problem is built-up step by step, starting with a robot and sensor model, generating and environment and first building the simple Localization problem using and Extended Kalman Filter (EKF), then the solution is expanded to cover the online SLAM problem, and Finally prior information is added to prove that this can actually grant global consistency without needing to close the loop.. Introduction The motivation for this project comes from how the aerial images from outdoor environments can be easily accessed by any person with a web connection and the growing importance of robotics in the academic and commercial worlds. o Related Work The idea of this work comes from the approach proposed in [1]. This approach the authors extract features from the global aerial images to have some initial information about the landmarks in the environment. Then as the robot moves and takes 3D laser scans of the environment the map is built using a Graph-based formulation to solve the SLAM problem. It is important to notice that the approach proposed in [1] includes more than just the SLAM solution since first the aerial images needs to be processed to extract the desired features (this process can be seen in Figure.1). Then for every step of the robot the problem starts with extracting a D projection from the 3D laser scans (see Figure.). After obtaining this, the association problem has to made to match every measurement with the corresponding landmark (Known as Association Problem), and finally after this is done is when the SLAM algorithm can be applied.

3 Figure.1. Image processing: (a) Google Earth image, (b) Result of edge extraction, (c) Resultant likelihood field. [1] Figure.. Shows: (a) 3D laser scan image of the area, (b) Google Earth image, (c) Edges extraction of aerial image, (d) Bird-eye projection of the 3D laser scan, (e) Positions extracted from (d). [1] o Scope For the purpose of this work, the goal is to achieve the same results given in [1] but with a simpler version in the sense that the focus will be only in the SLAM part, correspondences and prior information will be considered given for the purpose of this so no Image

4 Processing nor Association problem will be solved. Also instead of taking 3D laser scans with the sensor and computing the D bird-view projection, the sensor information will consider to be directly measuring the D distances. With respect to the SLAM problem, instead of Graph-SLAM formulation used in [1], this work will use an EKF formulation which will be build up step by step starting from a simple Localization problem, to then extend this to solve the Online SLAM problem and finally add the prior information. Table.1 shows the comparison between work done in [1] against the work done in this project. Table.1. The Proposed work for this paper against the Original work in [1]. 3. The Model o Motion model The model considered for the robot motion takes into account three parameters that locates a robot in a D space, this parameters that constitute the state are: {x, y, θ}. The control or input consider two variables which are,f, T-, where f describes a linear velocity command, and T defines an angular velocity command.

5 The model used is called a Velocity Motion Model and as shown in *+ it can be derived as follows: Consider a robot moving among a circular trajectory generated by applying a linear velocity ( f ) and an angular velocity ( T ) to the robot (See Figure 3.1). The radius of this circle is given by: ( 1 ) If the robot position is note by {x, y} and the center of the circle is denoted by {xc, yc}: ( ) ( ) ( ) ( ) ( ) ( 3 ) Now, if f and T remains constant over a time interval Δt, the new position of the robot will still be on the circle but shifted by an angle of T. Δt, solving from () and (3): ( ) ( ) ( ) ( ) ( ) ( 5 ) ( ) ( ) ( ) Mixing the previous equations in a state space representation we get the motion model ( 7 ) Note that this model doesn t work if the angular velocity command is zero (T=), to solve this issue, since the main use for the model will be to estimate the Sate and not to actually generate a straight trajectory we will just consider a very small value for T when the input command is zero

6 . Figure 3.1. Robot movement described by a circular trajectory. [] Linearization: The EKF that will be applied requires the use of a linearized version of the model for certain steps. This will be done according to Taylor expansion. Let X(k+1) = g(u, X) from equation (7) with X(t) = {x(t), y(t), θ(t)} been the state and U = {f(t), T(t)} the input. The Jacobian of g with respect to X is given by ( ) where gi stands for the i th row of g. Then: By evaluating the G at the current state a linearized model is obtained. Motion noise: The EKF formulation requires Additive White Gaussian Noise (AWGN). The noise is assumed to come in the control space as follows:

7 When converted into state space, the noise will come as: To compute the covariance matrix of the noise in state space Rk : where Vk is the Jacobian of g with respect to U o Sensor Model As sensor model we will be using a range bearing model, it measures the distance ( rk ) and angle ( θk ) of a landmark j with respect to the robot state at a given moment k. From basic trigonometry: Zk (j) h(x(k), M(j)) Zk(j) is the measurement of the jth landmark as a given step k of the robot motion, it is computed with the function h that depends on the robot state at step k ( Xk ) and the global position of the jth landmark ( Mj ). Note that for the localization problem the landmarks positions are fixed, this will not be the case for the SLAM problem.

8 Linearization: Again, the EKF formulation requires a linearized version of the model, this time for the sensor model. In this case the Jacobian H is given by: Sensor noise: As before the noise will be AWGN, and we will assume the range noise to be independent to the angular noise.. Localization Problem The localization problem consists on a robot moving on an environment with a known map expressed as landmarks, the goal is to give the best possible approximation of the robot s location according to the sensing of the landmarks. Figure.1 shows the Localization problem Set-up. Figure.1. A robot located in space with known landmarks, the measurements of the landmarks will provide the information needed to locate the robot as it moves around the environment.

9 o EKF formulation A Kalman Filter bases its estimation on considering a linear system to keep track of the expected value and covariance of the state as it propagates through a linear process. The EKF is just to make the Kalman Filter track a non-linear system by using linear approximations of the model computed around the present state for each point (or best approximation of the present state). The estimation process consists in two main steps: Prediction, corresponding to the upper section of Figure.; and Filtering, corresponding to the lower section of Figure.. Prediction Also known as A-priori estimation. It uses the input and the motion model to propagate the expected value and covariance of the state. This gives a first estimation of the state at the next time step. The equations for the prediction step are: where μk1 and Σk1 represents the expected value of state, and the covariance matrix at a time k+1; μk and Σk are the expected value of the state, and the covariance matrix at a time k; Uk is the input at time k. Linearization for Gk and Rk are made around the best estimation (A-posteriori estimation) of the state at time k. Filtering Also known as A-posteriori estimation. The measurement from the sensor has arrived and now this information is compared with the prediction stage results to give a refined estimation of the state. The equations for the filtering step are:

10 where μk and Σk are initialized as the A-priori estimation. Linearization for Hj (previously refereed as H) is done around the value μk. (Note that the meaning of k and k1 is different from the one used before in the sense that they don t refer to time k and time k+1 but just to belief and corrected estimation, they are both for time k+1 ). This filtering stage works with one landmark j at a time, in case more than one landmark is observed by the sensor, then the filter will run as many times as the number of landmarks in range, this way each of the measurements contributes to correct the estimation. In case no landmark is in range the sensor will not give any measurement and this step will be skipped, leaving the A-priori as the best possible estimation. Figure.. Extended Kalman Filter Overview. 5. SLAM Problem The SLAM problem is in essence very similar to the Localization Problem but now the map of the environment is also unknown, and the job now is to simultaneously estimate both, robot and landmark coordinates. To include the landmarks into the estimation the basic idea is just to create an extended state: Note that the map M now becomes M(k). ( ) ( ( ) ( ) ) Additionally for this part, the definition of each landmark will be expanded to:

11 where the parameter ms is called the signature and can be used to send information about the landmark which for our simulation will be the identification j. o From EKF Localization to EKF SLAM As stated before, the state is now expanded, but the idea of the EKF formulation remains. In regarding to the estimation of the Robot parameters, everything will be the same except for that now instead of the filter using known knowledge of the map to evaluate h(x(k),m(j)) and H, now it will use the best available estimation of those values (given by the A-priori or a filtering stage for the previous landmark), is important to notice that the matrix H has to be modified because partial derivatives now have to be taken with respect to the landmark coordinates too, so now: For the map we will assume static maps. The estimation of the map follows the same formulation than estimating the state but with some important considerations to take into account: 1) Since the map is considered static, the Prediction step should not modify the map estimation which is the same as considering the map state space dynamics as just an identity matrix ( M(k+1) = I.M(k) ). ) When a landmark is seen for the first time, its estimated position will be set according to the estimation of the robot s position plus the sensor measurement. And naturally the uncertainty (reflected by the covariance matrix) will come as a product of the robot s and sensor s uncertainty. 3) At the start of the simulation the landmarks have completely unknown positions and the state vector M() and covariance matrix Σ() should be initialized to reflect this. A good way to do it is proposed in [] by just setting the coordinates of the landmarks at the origin and the covariance matrix for the section corresponding to the landmarks as Diag( ). The full estimation will work by setting the robot s and map s estimators in parallel and while each of them working by its own, they are highly coupled because each of them takes the estimation of the other one in its formulation.

12 After all the considerations discussed the problem now reduces in how to set the formulas for Prediction and Filtering correctly to work both estimations in parallel. The method proposed in *+ relies in declaring an auxiliary matrix Fx to handle this. where N is the number of landmarks. 3N By taking Fx as proposed we can now rewrite the prediction step to satisfy the conditions discussed above as: The function g1 is similar to the full model g. And is given by: It is easy to see that with formulation the prediction stage fulfills the conditions discussed. Similarly, for the Filtering step, a matrix Fxj is proposed as follows: The filtering equations can be written as: 3j-3 3N-3j

13 Before these filtering equations it is important to check if the landmark has been previously observed and if not, initialize it at the coordinates where it is observed. This is done with the following equations just before each landmark processed in the filtering step:. SLAM with prior information One important result of the SLAM problem in order to obtain a globally consistent map and robot estimation, the trajectory of the robot needs to be such that it comes back to a previously observed landmark with small uncertainty, this will allow the global uncertainty of all landmarks and specially the robot s position to converge and have a reliable estimation, this property can be observed from the results of the SLAM problem in section 7. Having a limitation such as relaying in the robot to describe a loop like trajectory is very restrictive for some mobile robotics applications and some other solution needs to be found to achieve global consistency of the estimation. If we analyze what happens in the EKF algorithm is that once a landmark is first observed, it s expected value and covariance matrix are modified for the first time, in the case of the loopclosing trajectory, when the landmark is observed again, the filtering step uses the original previous information about the landmark to correct the estimation of the robots position and with that it corrects all other estimations for the landmarks. But what if instead of initializing the landmark information as if they are completely unknown, we use some prior information about the landmarks?, logically assuming there is such prior information. Well the behavior the first time that landmark is seen will be very similar as if there was a loop closing there (some initial information and some new information mixing for the filtering). This idea is the one to be demonstrated by using the prior in the EKF. The way to do this is actually very simple is the prior is given, just instead of having Y()={,,...,} and Σ() as previously described, use the prior information, Figure.1 shows the initialization with no prior and Figure. shows the initialization including prior information in the third and fifth landmarks.

14 Figure.1 State and covariance matrix initialization for the SLAM problem with 5 landmarks to consider, no prior information available. Figure. State and covariance matrix initialization for the SLAM problem with 5 landmarks to consider, prior information added.

15 7. Simulation Results RESULTS FOR LOCALIZATION PROBLEM As we can observe from figure 7.1, the robot moves with a relatively high uncertainty in the model, shown by the A-priori estimation ellipses, but when the sensor detects some landmarks the filtering allows the A-posteriori estimation to be much more certain, then as the robot moves away from the landmarks the uncertainty grows, and only one ellipse is observed, this is because they are actually overlapped since no landmark detection means A-priori and A-posteriori are the same. And when again just when the robot detects more landmarks the estimation becomes certain again as seen in section (d) of Figure 7.1, the A-priori had large uncertainty but the A-posteriori (resulting from filtering) is much more certain. ( a ) ( b ) Blue Rectangle Robot Blue dots Landmarks Dotted line Sensor range Blue ellipse Apriori uncertainity Red ellipse Aposteriori uncertainty ( c ) ( d ) Figure 7.1 EKF Localization Problem Simulation.

16 RESULTS FOR SLAM PROBLEM LANDMARKS Blue dots Real positions ( a ) Red crosses Estimated positions. ( b ) Blue ellipses Uncertainty of landmark. ROBOT Rectangles: Black Real position. Green- Noiseless trajectory. Red Apriori estimation. Blue Aposteriori estimation. Blue ellipse Apriori uncertainty Red ellipse Aposteriori uncertainty Dotted line Sensor range ( c ) ( d ) ( e ) ( f ) Figure 7. EKF SLAM Problem Simulation.

17 As shown in Figure 7. both landmarks and robot position start at the origin. As the robot moves its position becomes more and more uncertain, affecting with it the uncertainty of the landmarks it observes on the way, also, the real and estimated trajectories diverge more and more from each other. It is not until the robot closes the loop with a more certain landmark in part (d) of Figure 7. when the filtering can make significant corrections, this can be seen by comparing A- priori and A-posteriori estimations, the first one is very close to the path that the noiseless trajectory would follow and the second one very close to the actual position of the robot following the real trajectory; and also by a significant reduction in all uncertainty ellipses. Finally, after one more step where the robot is still able to see the landmark (Section (f) of Figure 7.), all estimations becomes even more accurate. RESULTS FOR SLAM PROBLEM WITH PRIOR INFORMATION The experiment again starts with the robot at the origin but some landmarks are initialized according to prior information, this can be seen as two of the landmarks in Figure 7.3 (a) have already their estimated position and uncertainty. Then again as in the previous case the robot s and landmarks uncertainty grows as the simulation advances, it can be observed a slight correction in the robot s estimation when the third landmark is observed, but the interesting result comes when the fifth landmark is observed because just one step before in Figure 7.3 (e), uncertainty is high for both the robot and the fourth landmark, but in Figure 7.3 (f) the robot observes the fifth landmark and because of the prior knowledge, the robot is able to again get a very good estimation of its location and also the fourth landmark s estimation gets better. This proves that the prior knowledge about a landmark behaves as a closing loop system without having to close the loop.

18 ( a ) ( b ) ( c ) ( d ) ( e ) ( f ) Figure 7.3 EKF SLAM with prior information Problem Simulation.

19 . Conclusions With the conclusion of this project, the Localization and SLAM techniques are clearly understood as well as the EKF setup and operation. The EKF approach can be effectively applied to solve both localization and SLAM problems and can also be extended to incorporate initial knowledge about the landmarks in the case of SLAM with prior information. When prior information about the landmarks is available the SLAM problem can achieve global consistency without having to close the loop. This EKF approach can be easily extended to applications outside the robotics field, as long as the system can be modeled and the sensing device is sufficient to grant an observable process and the noise is AWGN. By comparing the results obtained from this work with the ones from [1] it s possible to affirm that Graph-Slam and EKF formulations can both effectively solve the SLAM problem and after applying prior information, both can give similar results, the choice of which is better comes down to the kind of noise, computational resources available, and number of landmarks to be processed. References [1] Kummerle, Kleiner, etal. Large Scale Graph-based SLAM using Aerial Images as Prior Information. [] Thrun, S; Burgard, W; Fox,D Probabilistic Robotics, Cambridge, Mass. : MIT Press, c.

Autonomous Mobile Robot Design

Autonomous Mobile Robot Design Autonomous Mobile Robot Design Topic: EKF-based SLAM Dr. Kostas Alexis (CSE) These slides have partially relied on the course of C. Stachniss, Robot Mapping - WS 2013/14 Autonomous Robot Challenges Where

More information

Probabilistic Robotics. FastSLAM

Probabilistic Robotics. FastSLAM Probabilistic Robotics FastSLAM The SLAM Problem SLAM stands for simultaneous localization and mapping The task of building a map while estimating the pose of the robot relative to this map Why is SLAM

More information

Robot Mapping. A Short Introduction to the Bayes Filter and Related Models. Gian Diego Tipaldi, Wolfram Burgard

Robot Mapping. A Short Introduction to the Bayes Filter and Related Models. Gian Diego Tipaldi, Wolfram Burgard Robot Mapping A Short Introduction to the Bayes Filter and Related Models Gian Diego Tipaldi, Wolfram Burgard 1 State Estimation Estimate the state of a system given observations and controls Goal: 2 Recursive

More information

Probabilistic Robotics

Probabilistic Robotics Probabilistic Robotics FastSLAM Sebastian Thrun (abridged and adapted by Rodrigo Ventura in Oct-2008) The SLAM Problem SLAM stands for simultaneous localization and mapping The task of building a map while

More information

Robot Mapping. Least Squares Approach to SLAM. Cyrill Stachniss

Robot Mapping. Least Squares Approach to SLAM. Cyrill Stachniss Robot Mapping Least Squares Approach to SLAM Cyrill Stachniss 1 Three Main SLAM Paradigms Kalman filter Particle filter Graphbased least squares approach to SLAM 2 Least Squares in General Approach for

More information

Graphbased. Kalman filter. Particle filter. Three Main SLAM Paradigms. Robot Mapping. Least Squares Approach to SLAM. Least Squares in General

Graphbased. Kalman filter. Particle filter. Three Main SLAM Paradigms. Robot Mapping. Least Squares Approach to SLAM. Least Squares in General Robot Mapping Three Main SLAM Paradigms Least Squares Approach to SLAM Kalman filter Particle filter Graphbased Cyrill Stachniss least squares approach to SLAM 1 2 Least Squares in General! Approach for

More information

Data Association for SLAM

Data Association for SLAM CALIFORNIA INSTITUTE OF TECHNOLOGY ME/CS 132a, Winter 2011 Lab #2 Due: Mar 10th, 2011 Part I Data Association for SLAM 1 Introduction For this part, you will experiment with a simulation of an EKF SLAM

More information

Geometrical Feature Extraction Using 2D Range Scanner

Geometrical Feature Extraction Using 2D Range Scanner Geometrical Feature Extraction Using 2D Range Scanner Sen Zhang Lihua Xie Martin Adams Fan Tang BLK S2, School of Electrical and Electronic Engineering Nanyang Technological University, Singapore 639798

More information

Probabilistic Robotics

Probabilistic Robotics Probabilistic Robotics Sebastian Thrun Wolfram Burgard Dieter Fox The MIT Press Cambridge, Massachusetts London, England Preface xvii Acknowledgments xix I Basics 1 1 Introduction 3 1.1 Uncertainty in

More information

Robotics. Chapter 25-b. Chapter 25-b 1

Robotics. Chapter 25-b. Chapter 25-b 1 Robotics Chapter 25-b Chapter 25-b 1 Particle Filtering Particle filtering uses a population of particles (each particle is a state estimate) to localize a robot s position. This is called Monte Carlo

More information

Simultaneous Localization and Mapping

Simultaneous Localization and Mapping Sebastian Lembcke SLAM 1 / 29 MIN Faculty Department of Informatics Simultaneous Localization and Mapping Visual Loop-Closure Detection University of Hamburg Faculty of Mathematics, Informatics and Natural

More information

Particle Filters. CSE-571 Probabilistic Robotics. Dependencies. Particle Filter Algorithm. Fast-SLAM Mapping

Particle Filters. CSE-571 Probabilistic Robotics. Dependencies. Particle Filter Algorithm. Fast-SLAM Mapping CSE-571 Probabilistic Robotics Fast-SLAM Mapping Particle Filters Represent belief by random samples Estimation of non-gaussian, nonlinear processes Sampling Importance Resampling (SIR) principle Draw

More information

Particle Filter in Brief. Robot Mapping. FastSLAM Feature-based SLAM with Particle Filters. Particle Representation. Particle Filter Algorithm

Particle Filter in Brief. Robot Mapping. FastSLAM Feature-based SLAM with Particle Filters. Particle Representation. Particle Filter Algorithm Robot Mapping FastSLAM Feature-based SLAM with Particle Filters Cyrill Stachniss Particle Filter in Brief! Non-parametric, recursive Bayes filter! Posterior is represented by a set of weighted samples!

More information

Practical Course WS12/13 Introduction to Monte Carlo Localization

Practical Course WS12/13 Introduction to Monte Carlo Localization Practical Course WS12/13 Introduction to Monte Carlo Localization Cyrill Stachniss and Luciano Spinello 1 State Estimation Estimate the state of a system given observations and controls Goal: 2 Bayes Filter

More information

UNIVERSITÀ DEGLI STUDI DI GENOVA MASTER S THESIS

UNIVERSITÀ DEGLI STUDI DI GENOVA MASTER S THESIS UNIVERSITÀ DEGLI STUDI DI GENOVA MASTER S THESIS Integrated Cooperative SLAM with Visual Odometry within teams of autonomous planetary exploration rovers Author: Ekaterina Peshkova Supervisors: Giuseppe

More information

Navigation methods and systems

Navigation methods and systems Navigation methods and systems Navigare necesse est Content: Navigation of mobile robots a short overview Maps Motion Planning SLAM (Simultaneous Localization and Mapping) Navigation of mobile robots a

More information

Simuntaneous Localisation and Mapping with a Single Camera. Abhishek Aneja and Zhichao Chen

Simuntaneous Localisation and Mapping with a Single Camera. Abhishek Aneja and Zhichao Chen Simuntaneous Localisation and Mapping with a Single Camera Abhishek Aneja and Zhichao Chen 3 December, Simuntaneous Localisation and Mapping with asinglecamera 1 Abstract Image reconstruction is common

More information

Localization and Map Building

Localization and Map Building Localization and Map Building Noise and aliasing; odometric position estimation To localize or not to localize Belief representation Map representation Probabilistic map-based localization Other examples

More information

Optimization of the Simultaneous Localization and Map-Building Algorithm for Real-Time Implementation

Optimization of the Simultaneous Localization and Map-Building Algorithm for Real-Time Implementation 242 IEEE TRANSACTIONS ON ROBOTICS AND AUTOMATION, VOL. 17, NO. 3, JUNE 2001 Optimization of the Simultaneous Localization and Map-Building Algorithm for Real-Time Implementation José E. Guivant and Eduardo

More information

Robot Mapping. TORO Gradient Descent for SLAM. Cyrill Stachniss

Robot Mapping. TORO Gradient Descent for SLAM. Cyrill Stachniss Robot Mapping TORO Gradient Descent for SLAM Cyrill Stachniss 1 Stochastic Gradient Descent Minimize the error individually for each constraint (decomposition of the problem into sub-problems) Solve one

More information

DYNAMIC ROBOT LOCALIZATION AND MAPPING USING UNCERTAINTY SETS. M. Di Marco A. Garulli A. Giannitrapani A. Vicino

DYNAMIC ROBOT LOCALIZATION AND MAPPING USING UNCERTAINTY SETS. M. Di Marco A. Garulli A. Giannitrapani A. Vicino DYNAMIC ROBOT LOCALIZATION AND MAPPING USING UNCERTAINTY SETS M. Di Marco A. Garulli A. Giannitrapani A. Vicino Dipartimento di Ingegneria dell Informazione, Università di Siena, Via Roma, - 1 Siena, Italia

More information

Artificial Intelligence for Robotics: A Brief Summary

Artificial Intelligence for Robotics: A Brief Summary Artificial Intelligence for Robotics: A Brief Summary This document provides a summary of the course, Artificial Intelligence for Robotics, and highlights main concepts. Lesson 1: Localization (using Histogram

More information

Introduction to Mobile Robotics SLAM Landmark-based FastSLAM

Introduction to Mobile Robotics SLAM Landmark-based FastSLAM Introduction to Mobile Robotics SLAM Landmark-based FastSLAM Wolfram Burgard, Cyrill Stachniss, Maren Bennewitz, Diego Tipaldi, Luciano Spinello Partial slide courtesy of Mike Montemerlo 1 The SLAM Problem

More information

Robotics. Lecture 5: Monte Carlo Localisation. See course website for up to date information.

Robotics. Lecture 5: Monte Carlo Localisation. See course website  for up to date information. Robotics Lecture 5: Monte Carlo Localisation See course website http://www.doc.ic.ac.uk/~ajd/robotics/ for up to date information. Andrew Davison Department of Computing Imperial College London Review:

More information

Localization and Map Building

Localization and Map Building Localization and Map Building Noise and aliasing; odometric position estimation To localize or not to localize Belief representation Map representation Probabilistic map-based localization Other examples

More information

Introduction to Mobile Robotics. SLAM: Simultaneous Localization and Mapping

Introduction to Mobile Robotics. SLAM: Simultaneous Localization and Mapping Introduction to Mobile Robotics SLAM: Simultaneous Localization and Mapping The SLAM Problem SLAM is the process by which a robot builds a map of the environment and, at the same time, uses this map to

More information

Robotics. Chapter 25. Chapter 25 1

Robotics. Chapter 25. Chapter 25 1 Robotics Chapter 25 Chapter 25 1 Outline Robots, Effectors, and Sensors Localization and Mapping Motion Planning Chapter 25 2 Mobile Robots Chapter 25 3 Manipulators P R R R R R Configuration of robot

More information

ROBUST LOCALISATION OF AUTOMATED GUIDED VEHICLES FOR COMPUTER-INTEGRATED MANUFACTURING ENVIRONMENTS. R.C. Dixon 1 *, G.Bright 2 & R.

ROBUST LOCALISATION OF AUTOMATED GUIDED VEHICLES FOR COMPUTER-INTEGRATED MANUFACTURING ENVIRONMENTS. R.C. Dixon 1 *, G.Bright 2 & R. ROBUST LOCALISATION OF AUTOMATED GUIDED VEHICLES FOR COMPUTER-INTEGRATED MANUFACTURING ENVIRONMENTS R.C. Dixon 1 *, G.Bright 2 & R. Harley 3 1.2 Department of Mechanical Engineering University of KwaZulu-Natal,

More information

ICRA 2016 Tutorial on SLAM. Graph-Based SLAM and Sparsity. Cyrill Stachniss

ICRA 2016 Tutorial on SLAM. Graph-Based SLAM and Sparsity. Cyrill Stachniss ICRA 2016 Tutorial on SLAM Graph-Based SLAM and Sparsity Cyrill Stachniss 1 Graph-Based SLAM?? 2 Graph-Based SLAM?? SLAM = simultaneous localization and mapping 3 Graph-Based SLAM?? SLAM = simultaneous

More information

Localization, Where am I?

Localization, Where am I? 5.1 Localization, Where am I?? position Position Update (Estimation?) Encoder Prediction of Position (e.g. odometry) YES matched observations Map data base predicted position Matching Odometry, Dead Reckoning

More information

L12. EKF-SLAM: PART II. NA568 Mobile Robotics: Methods & Algorithms

L12. EKF-SLAM: PART II. NA568 Mobile Robotics: Methods & Algorithms L12. EKF-SLAM: PART II NA568 Mobile Robotics: Methods & Algorithms Today s Lecture Feature-based EKF-SLAM Review Data Association Configuration Space Incremental ML (i.e., Nearest Neighbor) Joint Compatibility

More information

Probabilistic Robotics

Probabilistic Robotics Probabilistic Robotics Bayes Filter Implementations Discrete filters, Particle filters Piecewise Constant Representation of belief 2 Discrete Bayes Filter Algorithm 1. Algorithm Discrete_Bayes_filter(

More information

BBR Progress Report 006: Autonomous 2-D Mapping of a Building Floor

BBR Progress Report 006: Autonomous 2-D Mapping of a Building Floor BBR Progress Report 006: Autonomous 2-D Mapping of a Building Floor Andy Sayler & Constantin Berzan November 30, 2010 Abstract In the past two weeks, we implemented and tested landmark extraction based

More information

State Estimation for Continuous-Time Systems with Perspective Outputs from Discrete Noisy Time-Delayed Measurements

State Estimation for Continuous-Time Systems with Perspective Outputs from Discrete Noisy Time-Delayed Measurements State Estimation for Continuous-Time Systems with Perspective Outputs from Discrete Noisy Time-Delayed Measurements António Pedro Aguiar aguiar@ece.ucsb.edu João Pedro Hespanha hespanha@ece.ucsb.edu Dept.

More information

Implementation of Odometry with EKF for Localization of Hector SLAM Method

Implementation of Odometry with EKF for Localization of Hector SLAM Method Implementation of Odometry with EKF for Localization of Hector SLAM Method Kao-Shing Hwang 1 Wei-Cheng Jiang 2 Zuo-Syuan Wang 3 Department of Electrical Engineering, National Sun Yat-sen University, Kaohsiung,

More information

CSE 490R P1 - Localization using Particle Filters Due date: Sun, Jan 28-11:59 PM

CSE 490R P1 - Localization using Particle Filters Due date: Sun, Jan 28-11:59 PM CSE 490R P1 - Localization using Particle Filters Due date: Sun, Jan 28-11:59 PM 1 Introduction In this assignment you will implement a particle filter to localize your car within a known map. This will

More information

Overview. EECS 124, UC Berkeley, Spring 2008 Lecture 23: Localization and Mapping. Statistical Models

Overview. EECS 124, UC Berkeley, Spring 2008 Lecture 23: Localization and Mapping. Statistical Models Introduction ti to Embedded dsystems EECS 124, UC Berkeley, Spring 2008 Lecture 23: Localization and Mapping Gabe Hoffmann Ph.D. Candidate, Aero/Astro Engineering Stanford University Statistical Models

More information

What is the SLAM problem?

What is the SLAM problem? SLAM Tutorial Slides by Marios Xanthidis, C. Stachniss, P. Allen, C. Fermuller Paul Furgale, Margarita Chli, Marco Hutter, Martin Rufli, Davide Scaramuzza, Roland Siegwart What is the SLAM problem? The

More information

Nonlinear Filtering with IMM Algorithm for Coastal Radar Target Tracking System

Nonlinear Filtering with IMM Algorithm for Coastal Radar Target Tracking System TELKOMNIKA, Vol.13, No.1, March 2015, pp. 211~220 ISSN: 1693-6930, accredited A by DIKTI, Decree No: 58/DIKTI/Kep/2013 DOI: 10.12928/TELKOMNIKA.v13i1.791 211 Nonlinear Filtering with IMM Algorithm for

More information

Mobile Robotics. Mathematics, Models, and Methods. HI Cambridge. Alonzo Kelly. Carnegie Mellon University UNIVERSITY PRESS

Mobile Robotics. Mathematics, Models, and Methods. HI Cambridge. Alonzo Kelly. Carnegie Mellon University UNIVERSITY PRESS Mobile Robotics Mathematics, Models, and Methods Alonzo Kelly Carnegie Mellon University HI Cambridge UNIVERSITY PRESS Contents Preface page xiii 1 Introduction 1 1.1 Applications of Mobile Robots 2 1.2

More information

High Accuracy Navigation Using Laser Range Sensors in Outdoor Applications

High Accuracy Navigation Using Laser Range Sensors in Outdoor Applications Proceedings of the 2000 IEEE International Conference on Robotics & Automation San Francisco, CA April 2000 High Accuracy Navigation Using Laser Range Sensors in Outdoor Applications Jose Guivant, Eduardo

More information

Principles of Robot Motion

Principles of Robot Motion Principles of Robot Motion Theory, Algorithms, and Implementation Howie Choset, Kevin Lynch, Seth Hutchinson, George Kantor, Wolfram Burgard, Lydia Kavraki, and Sebastian Thrun A Bradford Book The MIT

More information

Revising Stereo Vision Maps in Particle Filter Based SLAM using Localisation Confidence and Sample History

Revising Stereo Vision Maps in Particle Filter Based SLAM using Localisation Confidence and Sample History Revising Stereo Vision Maps in Particle Filter Based SLAM using Localisation Confidence and Sample History Simon Thompson and Satoshi Kagami Digital Human Research Center National Institute of Advanced

More information

ME 456: Probabilistic Robotics

ME 456: Probabilistic Robotics ME 456: Probabilistic Robotics Week 5, Lecture 2 SLAM Reading: Chapters 10,13 HW 2 due Oct 30, 11:59 PM Introduction In state esemaeon and Bayes filter lectures, we showed how to find robot s pose based

More information

Basics of Localization, Mapping and SLAM. Jari Saarinen Aalto University Department of Automation and systems Technology

Basics of Localization, Mapping and SLAM. Jari Saarinen Aalto University Department of Automation and systems Technology Basics of Localization, Mapping and SLAM Jari Saarinen Aalto University Department of Automation and systems Technology Content Introduction to Problem (s) Localization A few basic equations Dead Reckoning

More information

Nonlinear State Estimation for Robotics and Computer Vision Applications: An Overview

Nonlinear State Estimation for Robotics and Computer Vision Applications: An Overview Nonlinear State Estimation for Robotics and Computer Vision Applications: An Overview Arun Das 05/09/2017 Arun Das Waterloo Autonomous Vehicles Lab Introduction What s in a name? Arun Das Waterloo Autonomous

More information

ME 597/747 Autonomous Mobile Robots. Mid Term Exam. Duration: 2 hour Total Marks: 100

ME 597/747 Autonomous Mobile Robots. Mid Term Exam. Duration: 2 hour Total Marks: 100 ME 597/747 Autonomous Mobile Robots Mid Term Exam Duration: 2 hour Total Marks: 100 Instructions: Read the exam carefully before starting. Equations are at the back, but they are NOT necessarily valid

More information

COS Lecture 13 Autonomous Robot Navigation

COS Lecture 13 Autonomous Robot Navigation COS 495 - Lecture 13 Autonomous Robot Navigation Instructor: Chris Clark Semester: Fall 2011 1 Figures courtesy of Siegwart & Nourbakhsh Control Structure Prior Knowledge Operator Commands Localization

More information

Stereo Vision as a Sensor for EKF SLAM

Stereo Vision as a Sensor for EKF SLAM Stereo Vision as a Sensor for EKF SLAM Wikus Brink Electronic Systems Lab Electrical and Electronic Engineering University of Stellenbosch Email: 1483986@sun.ac.za Corné E. van Daalen Electronic Systems

More information

Today MAPS AND MAPPING. Features. process of creating maps. More likely features are things that can be extracted from images:

Today MAPS AND MAPPING. Features. process of creating maps. More likely features are things that can be extracted from images: MAPS AND MAPPING Features In the first class we said that navigation begins with what the robot can see. There are several forms this might take, but it will depend on: What sensors the robot has What

More information

GT "Calcul Ensembliste"

GT Calcul Ensembliste GT "Calcul Ensembliste" Beyond the bounded error framework for non linear state estimation Fahed Abdallah Université de Technologie de Compiègne 9 Décembre 2010 Fahed Abdallah GT "Calcul Ensembliste" 9

More information

Where s the Boss? : Monte Carlo Localization for an Autonomous Ground Vehicle using an Aerial Lidar Map

Where s the Boss? : Monte Carlo Localization for an Autonomous Ground Vehicle using an Aerial Lidar Map Where s the Boss? : Monte Carlo Localization for an Autonomous Ground Vehicle using an Aerial Lidar Map Sebastian Scherer, Young-Woo Seo, and Prasanna Velagapudi October 16, 2007 Robotics Institute Carnegie

More information

Maritime UAVs Swarm Intelligent Robot Modelling and Simulation using Accurate SLAM method and Rao Blackwellized Particle Filters

Maritime UAVs Swarm Intelligent Robot Modelling and Simulation using Accurate SLAM method and Rao Blackwellized Particle Filters 20th International Congress on Modelling and Simulation, Adelaide, Australia, 1 6 December 2013 www.mssanz.org.au/modsim2013 Maritime UAVs Swarm Intelligent Robot Modelling and Simulation using Accurate

More information

C-SAM: Multi-Robot SLAM using Square Root Information Smoothing

C-SAM: Multi-Robot SLAM using Square Root Information Smoothing IEEE International Conference on Robotics and Automation Pasadena, CA, USA, May 19-3, C-SAM: Multi-Robot SLAM using Square Root Information Smoothing Lars A. A. Andersson and Jonas Nygårds Abstract This

More information

L10. PARTICLE FILTERING CONTINUED. NA568 Mobile Robotics: Methods & Algorithms

L10. PARTICLE FILTERING CONTINUED. NA568 Mobile Robotics: Methods & Algorithms L10. PARTICLE FILTERING CONTINUED NA568 Mobile Robotics: Methods & Algorithms Gaussian Filters The Kalman filter and its variants can only model (unimodal) Gaussian distributions Courtesy: K. Arras Motivation

More information

2005 IEEE. Personal use of this material is permitted. Permission from IEEE must be obtained for all other uses, in any current or future media,

2005 IEEE. Personal use of this material is permitted. Permission from IEEE must be obtained for all other uses, in any current or future media, 25 IEEE Personal use of this material is permitted Permission from IEEE must be obtained for all other uses in any current or future media including reprinting/republishing this material for advertising

More information

Motion Control Strategies for Improved Multi Robot Perception

Motion Control Strategies for Improved Multi Robot Perception Motion Control Strategies for Improved Multi Robot Perception R Aragues J Cortes C Sagues Abstract This paper describes a strategy to select optimal motions of multi robot systems equipped with cameras

More information

Introduction to Mobile Robotics Bayes Filter Particle Filter and Monte Carlo Localization. Wolfram Burgard

Introduction to Mobile Robotics Bayes Filter Particle Filter and Monte Carlo Localization. Wolfram Burgard Introduction to Mobile Robotics Bayes Filter Particle Filter and Monte Carlo Localization Wolfram Burgard 1 Motivation Recall: Discrete filter Discretize the continuous state space High memory complexity

More information

Introduction to Robotics

Introduction to Robotics Introduction to Robotics Ph.D. Antonio Marin-Hernandez Artificial Intelligence Department Universidad Veracruzana Sebastian Camacho # 5 Xalapa, Veracruz Robotics Action and Perception LAAS-CNRS 7, av du

More information

Zürich. Roland Siegwart Margarita Chli Martin Rufli Davide Scaramuzza. ETH Master Course: L Autonomous Mobile Robots Summary

Zürich. Roland Siegwart Margarita Chli Martin Rufli Davide Scaramuzza. ETH Master Course: L Autonomous Mobile Robots Summary Roland Siegwart Margarita Chli Martin Rufli Davide Scaramuzza ETH Master Course: 151-0854-00L Autonomous Mobile Robots Summary 2 Lecture Overview Mobile Robot Control Scheme knowledge, data base mission

More information

5. Tests and results Scan Matching Optimization Parameters Influence

5. Tests and results Scan Matching Optimization Parameters Influence 126 5. Tests and results This chapter presents results obtained using the proposed method on simulated and real data. First, it is analyzed the scan matching optimization; after that, the Scan Matching

More information

Introduction to Mobile Robotics SLAM Grid-based FastSLAM. Wolfram Burgard, Cyrill Stachniss, Maren Bennewitz, Diego Tipaldi, Luciano Spinello

Introduction to Mobile Robotics SLAM Grid-based FastSLAM. Wolfram Burgard, Cyrill Stachniss, Maren Bennewitz, Diego Tipaldi, Luciano Spinello Introduction to Mobile Robotics SLAM Grid-based FastSLAM Wolfram Burgard, Cyrill Stachniss, Maren Bennewitz, Diego Tipaldi, Luciano Spinello 1 The SLAM Problem SLAM stands for simultaneous localization

More information

SLAM with SIFT (aka Mobile Robot Localization and Mapping with Uncertainty using Scale-Invariant Visual Landmarks ) Se, Lowe, and Little

SLAM with SIFT (aka Mobile Robot Localization and Mapping with Uncertainty using Scale-Invariant Visual Landmarks ) Se, Lowe, and Little SLAM with SIFT (aka Mobile Robot Localization and Mapping with Uncertainty using Scale-Invariant Visual Landmarks ) Se, Lowe, and Little + Presented by Matt Loper CS296-3: Robot Learning and Autonomy Brown

More information

Combined Trajectory Planning and Gaze Direction Control for Robotic Exploration

Combined Trajectory Planning and Gaze Direction Control for Robotic Exploration Combined Trajectory Planning and Gaze Direction Control for Robotic Exploration Georgios Lidoris, Kolja Kühnlenz, Dirk Wollherr and Martin Buss Institute of Automatic Control Engineering (LSR) Technische

More information

(W: 12:05-1:50, 50-N202)

(W: 12:05-1:50, 50-N202) 2016 School of Information Technology and Electrical Engineering at the University of Queensland Schedule of Events Week Date Lecture (W: 12:05-1:50, 50-N202) 1 27-Jul Introduction 2 Representing Position

More information

Robot Mapping. Hierarchical Pose-Graphs for Online Mapping. Gian Diego Tipaldi, Wolfram Burgard

Robot Mapping. Hierarchical Pose-Graphs for Online Mapping. Gian Diego Tipaldi, Wolfram Burgard Robot Mapping Hierarchical Pose-Graphs for Online Mapping Gian Diego Tipaldi, Wolfram Burgard 1 Graph-Based SLAM Measurements connect the poses of the robot while it is moving Measurements are inherently

More information

Graph-Based SLAM (Chap. 15) Robot Mapping. Hierarchical Pose-Graphs for Online Mapping. Graph-Based SLAM (Chap. 15) Graph-Based SLAM (Chap.

Graph-Based SLAM (Chap. 15) Robot Mapping. Hierarchical Pose-Graphs for Online Mapping. Graph-Based SLAM (Chap. 15) Graph-Based SLAM (Chap. Robot Mapping Hierarchical Pose-Graphs for Online Mapping Graph-Based SLAM (Chap. 15)! Constraints connect the poses of the robot while it is moving! Constraints are inherently uncertain Cyrill Stachniss

More information

Trajectory Generation for Constant Velocity Target Motion Estimation Using Monocular Vision

Trajectory Generation for Constant Velocity Target Motion Estimation Using Monocular Vision Trajectory Generation for Constant Velocity Targ Motion Estimation Using Monocular Vision Eric W. Frew, Stephen M. Rock Aerospace Robotics Laboratory Department of Aeronautics and Astronautics Stanford

More information

Simultaneous local and global state estimation for robotic navigation

Simultaneous local and global state estimation for robotic navigation Simultaneous local and global state estimation for robotic navigation The MIT Faculty has made this article openly available. Please share how this access benefits you. Your story matters. Citation As

More information

MULTI-ROBOT research has gained a broad attention. A Novel Way to Implement Self-localization in a Multi-robot Experimental Platform

MULTI-ROBOT research has gained a broad attention. A Novel Way to Implement Self-localization in a Multi-robot Experimental Platform 21 American Control Conference Marriott Waterfront, Baltimore, MD, USA June 3-July 2, 21 FrC16.5 A Novel Way to Implement Self-localization in a Multi-robot Experimental Platform Sheng Zhao and Manish

More information

Monocular SLAM with Inverse Scaling Parametrization

Monocular SLAM with Inverse Scaling Parametrization Monocular SLAM with Inverse Scaling Parametrization D. Marzorati 2, M. Matteucci 1, D. Migliore 1, and D. G. Sorrenti 2 1 Dept. Electronics and Information, Politecnico di Milano 2 Dept. Informatica, Sistem.

More information

NERC Gazebo simulation implementation

NERC Gazebo simulation implementation NERC 2015 - Gazebo simulation implementation Hannan Ejaz Keen, Adil Mumtaz Department of Electrical Engineering SBA School of Science & Engineering, LUMS, Pakistan {14060016, 14060037}@lums.edu.pk ABSTRACT

More information

Online Simultaneous Localization and Mapping in Dynamic Environments

Online Simultaneous Localization and Mapping in Dynamic Environments To appear in Proceedings of the Intl. Conf. on Robotics and Automation ICRA New Orleans, Louisiana, Apr, 2004 Online Simultaneous Localization and Mapping in Dynamic Environments Denis Wolf and Gaurav

More information

SLAM With Sparse Sensing

SLAM With Sparse Sensing To appear in the 2006 IEEE International Conference on Robotics & Automation (ICRA 2006) SLAM With Sparse Sensing Kristopher R. Beevers Wesley H. Huang Rensselaer Polytechnic Institute, Department of Computer

More information

Robot Mapping. Grid Maps. Gian Diego Tipaldi, Wolfram Burgard

Robot Mapping. Grid Maps. Gian Diego Tipaldi, Wolfram Burgard Robot Mapping Grid Maps Gian Diego Tipaldi, Wolfram Burgard 1 Features vs. Volumetric Maps Courtesy: D. Hähnel Courtesy: E. Nebot 2 Features So far, we only used feature maps Natural choice for Kalman

More information

Spring Localization II. Roland Siegwart, Margarita Chli, Juan Nieto, Nick Lawrance. ASL Autonomous Systems Lab. Autonomous Mobile Robots

Spring Localization II. Roland Siegwart, Margarita Chli, Juan Nieto, Nick Lawrance. ASL Autonomous Systems Lab. Autonomous Mobile Robots Spring 2018 Localization II Localization I 16.04.2018 1 knowledge, data base mission commands Localization Map Building environment model local map position global map Cognition Path Planning path Perception

More information

L15. POSE-GRAPH SLAM. NA568 Mobile Robotics: Methods & Algorithms

L15. POSE-GRAPH SLAM. NA568 Mobile Robotics: Methods & Algorithms L15. POSE-GRAPH SLAM NA568 Mobile Robotics: Methods & Algorithms Today s Topic Nonlinear Least Squares Pose-Graph SLAM Incremental Smoothing and Mapping Feature-Based SLAM Filtering Problem: Motion Prediction

More information

RoboCupRescue - Simulation League Team RescueRobots Freiburg (Germany)

RoboCupRescue - Simulation League Team RescueRobots Freiburg (Germany) RoboCupRescue - Simulation League Team RescueRobots Freiburg (Germany) Alexander Kleiner and Vittorio Amos Ziparo Institut für Informatik Foundations of AI Universität Freiburg, 79110 Freiburg, Germany

More information

UAV Autonomous Navigation in a GPS-limited Urban Environment

UAV Autonomous Navigation in a GPS-limited Urban Environment UAV Autonomous Navigation in a GPS-limited Urban Environment Yoko Watanabe DCSD/CDIN JSO-Aerial Robotics 2014/10/02-03 Introduction 2 Global objective Development of a UAV onboard system to maintain flight

More information

Robot Localization based on Geo-referenced Images and G raphic Methods

Robot Localization based on Geo-referenced Images and G raphic Methods Robot Localization based on Geo-referenced Images and G raphic Methods Sid Ahmed Berrabah Mechanical Department, Royal Military School, Belgium, sidahmed.berrabah@rma.ac.be Janusz Bedkowski, Łukasz Lubasiński,

More information

Humanoid Robotics. Monte Carlo Localization. Maren Bennewitz

Humanoid Robotics. Monte Carlo Localization. Maren Bennewitz Humanoid Robotics Monte Carlo Localization Maren Bennewitz 1 Basis Probability Rules (1) If x and y are independent: Bayes rule: Often written as: The denominator is a normalizing constant that ensures

More information

Appearance-based Concurrent Map Building and Localization

Appearance-based Concurrent Map Building and Localization Appearance-based Concurrent Map Building and Localization Josep M. Porta and Ben J.A. Kröse IAS Group, Informatics Institute, University of Amsterdam Kruislaan 403, 1098SJ, Amsterdam, The Netherlands {porta,krose}@science.uva.nl

More information

Visual Bearing-Only Simultaneous Localization and Mapping with Improved Feature Matching

Visual Bearing-Only Simultaneous Localization and Mapping with Improved Feature Matching Visual Bearing-Only Simultaneous Localization and Mapping with Improved Feature Matching Hauke Strasdat, Cyrill Stachniss, Maren Bennewitz, and Wolfram Burgard Computer Science Institute, University of

More information

This chapter explains two techniques which are frequently used throughout

This chapter explains two techniques which are frequently used throughout Chapter 2 Basic Techniques This chapter explains two techniques which are frequently used throughout this thesis. First, we will introduce the concept of particle filters. A particle filter is a recursive

More information

Implementation of SLAM algorithms in a small-scale vehicle using model-based development

Implementation of SLAM algorithms in a small-scale vehicle using model-based development Master of Science Thesis in Datorteknik, Fordonssystem Department of Electrical Engineering, Linköping University, 2017 Implementation of SLAM algorithms in a small-scale vehicle using model-based development

More information

AWireless sensor network has been successfully applied to. Vision-Based Coordinated Localization for Mobile Sensor Networks

AWireless sensor network has been successfully applied to. Vision-Based Coordinated Localization for Mobile Sensor Networks Vision-Based Coordinated Localization for Mobile Sensor Networks Junghun Suh, Student Member, IEEE, Seungil You, Student Member, IEEE, Sungjoon Choi, Student Member, IEEE and Songhwai Oh, Member, IEEE

More information

Tracking. Establish where an object is, other aspects of state, using time sequence Biggest problem -- Data Association

Tracking. Establish where an object is, other aspects of state, using time sequence Biggest problem -- Data Association Tracking Establish where an object is, other aspects of state, using time sequence Biggest problem -- Data Association Key ideas Tracking by detection Tracking through flow Track by detection (simple form)

More information

CANAL FOLLOWING USING AR DRONE IN SIMULATION

CANAL FOLLOWING USING AR DRONE IN SIMULATION CANAL FOLLOWING USING AR DRONE IN SIMULATION ENVIRONMENT Ali Ahmad, Ahmad Aneeque Khalid Department of Electrical Engineering SBA School of Science & Engineering, LUMS, Pakistan {14060006, 14060019}@lums.edu.pk

More information

AUTONOMOUS SYSTEMS. PROBABILISTIC LOCALIZATION Monte Carlo Localization

AUTONOMOUS SYSTEMS. PROBABILISTIC LOCALIZATION Monte Carlo Localization AUTONOMOUS SYSTEMS PROBABILISTIC LOCALIZATION Monte Carlo Localization Maria Isabel Ribeiro Pedro Lima With revisions introduced by Rodrigo Ventura Instituto Superior Técnico/Instituto de Sistemas e Robótica

More information

Efficient SLAM Scheme Based ICP Matching Algorithm Using Image and Laser Scan Information

Efficient SLAM Scheme Based ICP Matching Algorithm Using Image and Laser Scan Information Proceedings of the World Congress on Electrical Engineering and Computer Systems and Science (EECSS 2015) Barcelona, Spain July 13-14, 2015 Paper No. 335 Efficient SLAM Scheme Based ICP Matching Algorithm

More information

Mobile robot localisation and navigation using multi-sensor fusion via interval analysis and UKF

Mobile robot localisation and navigation using multi-sensor fusion via interval analysis and UKF Mobile robot localisation and navigation using multi-sensor fusion via interval analysis and UKF Immanuel Ashokaraj, Antonios Tsourdos, Peter Silson and Brian White. Department of Aerospace, Power and

More information

DEALING WITH SENSOR ERRORS IN SCAN MATCHING FOR SIMULTANEOUS LOCALIZATION AND MAPPING

DEALING WITH SENSOR ERRORS IN SCAN MATCHING FOR SIMULTANEOUS LOCALIZATION AND MAPPING Inženýrská MECHANIKA, roč. 15, 2008, č. 5, s. 337 344 337 DEALING WITH SENSOR ERRORS IN SCAN MATCHING FOR SIMULTANEOUS LOCALIZATION AND MAPPING Jiří Krejsa, Stanislav Věchet* The paper presents Potential-Based

More information

Tracking Multiple Moving Objects with a Mobile Robot

Tracking Multiple Moving Objects with a Mobile Robot Tracking Multiple Moving Objects with a Mobile Robot Dirk Schulz 1 Wolfram Burgard 2 Dieter Fox 3 Armin B. Cremers 1 1 University of Bonn, Computer Science Department, Germany 2 University of Freiburg,

More information

1 Differential Drive Kinematics

1 Differential Drive Kinematics CS W4733 NOTES - Differential Drive Robots Note: these notes were compiled from Dudek and Jenkin, Computational Principles of Mobile Robotics. 1 Differential Drive Kinematics Many mobile robots use a drive

More information

Final Exam Practice Fall Semester, 2012

Final Exam Practice Fall Semester, 2012 COS 495 - Autonomous Robot Navigation Final Exam Practice Fall Semester, 2012 Duration: Total Marks: 70 Closed Book 2 hours Start Time: End Time: By signing this exam, I agree to the honor code Name: Signature:

More information

Turning an Automated System into an Autonomous system using Model-Based Design Autonomous Tech Conference 2018

Turning an Automated System into an Autonomous system using Model-Based Design Autonomous Tech Conference 2018 Turning an Automated System into an Autonomous system using Model-Based Design Autonomous Tech Conference 2018 Asaf Moses Systematics Ltd., Technical Product Manager aviasafm@systematics.co.il 1 Autonomous

More information

MULTI-MODAL MAPPING. Robotics Day, 31 Mar Frank Mascarich, Shehryar Khattak, Tung Dang

MULTI-MODAL MAPPING. Robotics Day, 31 Mar Frank Mascarich, Shehryar Khattak, Tung Dang MULTI-MODAL MAPPING Robotics Day, 31 Mar 2017 Frank Mascarich, Shehryar Khattak, Tung Dang Application-Specific Sensors Cameras TOF Cameras PERCEPTION LiDAR IMU Localization Mapping Autonomy Robotic Perception

More information

High-precision, consistent EKF-based visual-inertial odometry

High-precision, consistent EKF-based visual-inertial odometry High-precision, consistent EKF-based visual-inertial odometry Mingyang Li and Anastasios I. Mourikis, IJRR 2013 Ao Li Introduction What is visual-inertial odometry (VIO)? The problem of motion tracking

More information

Probabilistic Robotics

Probabilistic Robotics Probabilistic Robotics Discrete Filters and Particle Filters Models Some slides adopted from: Wolfram Burgard, Cyrill Stachniss, Maren Bennewitz, Kai Arras and Probabilistic Robotics Book SA-1 Probabilistic

More information

Reference Tracking System for a Mobile Skid Steer Robot (Version 1.00)

Reference Tracking System for a Mobile Skid Steer Robot (Version 1.00) CENTER FOR MACHINE PERCEPTION CZECH TECHNICAL UNIVERSITY IN PRAGUE Reference Tracking System for a Mobile Skid Steer Robot (Version 1.00) Vladimír Kubelka, Vladimír Burian, Přemysl Kafka kubelka.vladimir@fel.cvut.cz

More information