Robotic Perception and Action: Vehicle SLAM Assignment

Size: px
Start display at page:

Download "Robotic Perception and Action: Vehicle SLAM Assignment"

Transcription

1 Robotic Perception and Action: Vehicle SLAM Assignment Mariolino De Cecco Mariolino De Cecco, Mattia Tavernini 1

2 CONTENTS Vehicle SLAM Assignment Contents Assignment Scenario 3 Odometry Localization Matrix C Xk Matrix J Φwk Matrix C wk Matrix S wk Matrix I k Data Provided Aruco Localization UWB Positioning Problem 1 8 (Odometry Incremental Localization) Problem 2 8 (Odometry and Aruco Incremental Localization) Problem 3 9 (Odometry and Aruco SLAM) Problem 4 9 (Odometry, Aruco and UWB SLAM) Results 10 Page 2 of 10

3 Vehicle SLAM Assignment Assignment Scenario Consider a Differential Drive Vehicle ables to move in an unknown environment with the following sensors: Rotational encoders on both the wheel drive (Odometry Localization); RGB Camera capable to detect a certain number of artificial landmarks placed in the environment in unknown positions and orientations. An onboard computer is capable to collect the images and to extract the bi-dimensional pose of the landmarks identified (Aruco Localization); Ultra Wide Band Positioning, and indoor positioning system based on the radio technology with a set of receivers placed in the environment and a reference tag on the vehicle (UWB Positioning). Figure 1: Differential drive kinematic model and development robot The aim of the work is to perform the localization of the vehicle and when it is possible, to map the artificial landmark placed in the environment. In the next paragraphs there are more details on the localization system and the data provided. Odometry Localization Odometry (Incremental) Localization can be done with the knowledge of the vehicle kinematic model, the vehicle kinematic parameters and the encoder readings. Since the vehicle is controlled by the two driving wheels, the rotational encoders are mounted on the wheel. It can be assumed that both the encoders have the same characteristics. The measurements acquired are the incremental number of counts on wheels. The vehicle is localized by using the discrete form of odometric navigation reported in [1] and [2]: x k+1 = x k + π nrkr R +n Lk R L n 0 cos(δ k ) y k+1 = y k + π nrkr R +n Lk R L n 0 sin(δ k ) δ k+1 = δ k + 2π nrkr R n Lk R L where: b n 0 (1) x k+1 is the update vehicle x position starting from the previous knowledge x k, y k+1 is the update vehicle y position starting from the previous knowledge y k, δ k+1 is the update vehicle δ attitude starting from the previous knowledge δ k, n Rk is the incremental counter of the encoder on the right wheel, n Lk is the incremental counter of the encoder on the left wheel, n 0 is the counter per revolution of both the encoder (assuming that they have same characteristics), Assignment Scenario continued on next page... Page 3 of 10

4 Odometry Localization Vehicle SLAM Assignment Assignment Scenario (continued) R R is the radius of the right wheel, R L is the radius of the left wheel, b is the vehicle wheelbase. In the same article is reported the method to use in order to estimate the odometric localization uncertainty, starting from the uncertainty of the wheel radii, the wheelbase and the initial vehicle attitude. This formulation already include the uncertainty propagation, and id performed in this way: in which: C Xk+1 = C Xk + J Φwk C wk J T Φ wk + J Φwk S wk I T k + I k S wk J T Φ wk (2) In the next paragraphs are described these matrices. I k = I k 1 + J Φk 1 S wk 1 (3) Matrix C Xk The matrix C Xk represents the covariance matrix of the vehicle pose X k at the discrete time step k. With the previous formulation it is possible to estimate the covariance of the vehicle pose at each step, taking already into account the propagation uncertainty (and so the drift). Matrix J Φwk The matrix J Φwk is the Jacobian of the non linear function Φ wk that permits to perform the pose update: X k+1 = X k + Φ wk w k is the vector of the variables that affect the accuracy of the vehicle pose, in this case it is: w k = [R R, R L, b, δ k ] This means that the parameters that affect the accuracy on vehicle pose estimation are the uncertainty on wheel radii, the wheelbase and the attitude at the previous step. The Jacobian J Φwk has to be computed on the discrete vehicle pose update of equation (1). J Φwk = (x k+1 x k ) R R (y k+1 y k ) (x k+1 x k ) R L (y k+1 y k ) (x k+1 x k ) b (y k+1 y k ) R R (δ k+1 δ k ) R L (δ k+1 δ k ) b (δ k+1 δ k ) R R R L b (x k+1 x k ) δ k (y k+1 y k ) δ k (δ k+1 δ k ) δ k The algebraic formulation of the derivatives in the Jacobian are always the same, the Jacobian must be evaluated each time with the current values. Matrix C wk This matrix take care of the uncertainties of the variables on vector w k. Assuming that all this variables are independents, it can be simplified as: σ 2 R R C wk = 0 σr 2 L σb σδ 2 k The element σr 2 R, σr 2 L and σb 2 are always the same and are given in the parameter section. On the contrary, the value of σδ 2 k must be update at every iteration with the previous value that can be found in C Xk. Assignment Scenario continued on next page... Page 4 of 10

5 Aruco Localization Vehicle SLAM Assignment Assignment Scenario (continued) Matrix S wk The elements of the matrix S wk are simply the square roots of C wk elements. Matrix I k This matrix represents the integral terms of the encoder uncertainty propagation, it can be computed by using the equation (3). It can be initialized as < 3 4 > zeros matrix at the first step. Data Provided The data provided for this localization is the encoderreading.txt file, that is organized as follow: The other pose number Right encoder counter tick Left encoder counter tick n tickr tickl parameters for the vehicle localization are: Table 1: encoderreading.txt file organization Parameters Description Value R R Radius of the right wheel [meters] 0.1 R L Radius of the left wheel [meters] 0.1 b Vehicle wheelbase [meters] 0.4 n 0 Count per revolution (both encoders) 8000 σ RR Standard deviation on Right wheel radius [meters] 1e-4 σ RL Standard deviation on Right wheel radius [meters] 1e-4 σ b Standard deviation on wheelbase [meters] 1e-4 σ δk Initial Standard deviation on vehicle attitude [rads] 1e-4 Table 2: Vehicle kinematic model parameters Aruco Localization The Aruco Localization is based on a calibrated camera and a set of known markers on the ceiling as depicted on (Figure 2). Once the transformation between the camera sensor and the vehicle is known it is possible to estimate the pose of the Aruco marker in the vehicle reference system. The Aruco Localization is achieved by means of a computer vision algorithm that is capable to detect the Aruco marker and to estimate their 3D pose (Figure 3). Since the camera has a planar motion (it is mounted on the vehicle identified by its pose X = (x, y, δ)) and the markers are assumed to be parallel to the camera motion, the 3D pose can be translated into a 2D pose. The data provided for this localization are, for each vehicle pose and for each Aruco marker, the marker unique-id, its estimated bi-dimensional pose in the vehicle reference system and its uncertainty. This information are defined as follow: i is the vehicle pose index i = 1..n, Assignment Scenario continued on next page... Page 5 of 10

6 Aruco Localization Vehicle SLAM Assignment Assignment Scenario (continued) (a) Camera (b) Aruco Marker on ceiling Figure 2: Camera mounted on vehicle (a) used to detect the Aruco marker on ceiling (b) Figure 3: Software to detect the Aruco marker and estimated their 3D pose j is the landmark index j = 1..m, Zj i = (x j, y j, δ j ) i is the j th Aruco marker pose measurement from the i th vehicle pose, σxx 2 σxy 2 σ xδ 2 C Z i j = σyx 2 σyy 2 σyδ 2 σδx 2 σδy 2 σδδ 2 i j is the covariance matrix associated to the measurement Z i j. All this information are collected in the text file ArucoReading.txt. pose id landmark id x i j y i j δ i j σ xx σ xy σ xδ σ yy σ yδ σ δδ i j n j Table 3: ArucoReading.txt file organization Assignment Scenario continued on next page... Page 6 of 10

7 UWB Positioning Vehicle SLAM Assignment Assignment Scenario (continued) UWB Positioning The Ultra Wide Band (UWB) Positioning is a method that in the last years has been improved. Its configuration is very similar to the GPS Positioning, with the only difference that in this case is the tag that emits a UWB signal to the antennas positioned in the environment (Figure 4). Figure 4: Similarity between GPS positioning and UWB positioning The antennas can only return the distance of the tag (placed on the vehicle). The vehicle position has to be evaluated by using a triangulation algorithm as depicted in Figure 5. It must be noticed that the tag is described only by its position: with triangulation it is not possible to evaluate the vehicle attitude. For this reason the method is called Positioning (that means find the position (x i, y i ) of the vehicle)and not Localization (that means find the pose (x i, y i, δ i ) of the vehicle). Figure 5: Position estimation by triangulation The information achievable from this measurement system are: i is the vehicle pose index i = 1..p, k is the antenna index k = 1..m, rk i is the j th antenna distance measurement from the i th vehicle pose, σ r i k is the standard deviation associated to the distance measurement r i k. All this information are collected in the text file UwbReading.txt. Only for this positioning system are given a guess solution for the antenna positions in the environment, collected in the text file UwbAntennaGuess.txt. Page 7 of 10

8 Vehicle SLAM Assignment Assignment Scenario pose id antenna id r i k σ r i k i k.... n k.... Table 4: UwbReading.txt file organization antenna id x position y position k p.... Table 5: UwbAntennaGuess.txt file organization Problem 1 (Odometry Incremental Localization) In this first problem is request to perform the vehicle localization using the raw encoder data in the encoderreading.txt file. The incremental pose has to be estimated using the Equation 1 while the uncertainty can be estimated with the Equation 2. It is important to notice that the formulation of Equation 2 already include the uncertainty propagation. Problem 2 (Odometry and Aruco Incremental Localization) In this second problem, it is introduced the Aruco measurement. In particular is required to perform an Incremental Localization using the Aruco measurement (like the class exercise without encoder data). All the necessary information for this step can be found in the ArucoReading.txt file. N.B.: As in real measurement the measurement ratio of the Aruco markers is lower than the encoder. This means that while using encoder there is a measurement for each vehicle pose, using the Aruco only in some vehicle poses i there is a measurement. Facultative: As facultative improvement try to fuse the information of the Odometry Incremental Localization with the Aruco Incremental Localization. As hint, both the localization must be perform at same time, and the uncertainty propagation of encoder Equation 2 has to start from the previous fused (with Aruco) C Xk when there is an Aruco measurement. Page 8 of 10

9 Vehicle SLAM Assignment Problem 2 Problem 3 (Odometry and Aruco SLAM) Use the information of odometry and Aruco markers to perform a SLAM (Simultaneous Localization and Mapping) with the GTSAM library. The data to use in this case are: file encoderreading.txt file ArucoReading.txt As initial solution for the vehicle poses graph you can use the odometry incremental localization. Regarding the landmark initial pose for the graph, select the most appropriate way and justify the choice. Problem 4 (Odometry, Aruco and UWB SLAM) By using all the information given, develop a SLAM with the GTSAM library using in addition, with respect to the Problem 3, the information of the UWB sensors. The data to use in this case are: file encoderreading.txt file ArucoReading.txt file UwbReading.txt For the initial solution of the UWB Antenna positions use the guess in the file UwbAntennaGuess.txt. Provide the map of the Aruco markers and UWB antennas. N.B.1:: UWB antennas are identified with a position and not a pose N.B.1:: UWB antennas and Aruco markers are different landmarks, placed in different place in the environment. Page 9 of 10

10 Vehicle SLAM Assignment Problem 4 Results They are provided two datasets (a short and a long path). For each problem (and dataset), provide (when it is possible) the following data: vehiclepose.mat Structure with the reconstructed vehicle pose and covariance: ArucoMap.mat Structure with the solved Aruco map: UwbMap.mat Structure with the solved UWB map: vehiclep ose(..).pose = [x, y, δ] vehiclep ose(..).covari =< 3x3 > matrix ArucoMap(..).pose = [x, y, δ] ArucoM ap(..).covari =< 3x3 > matrix UwbMap(..).position = [x, y] UwbMap(..).covariance =< 2x2 > matrix References [1] Mariolino De Cecco, Luca Baglivo, and Francesco Angrilli. Real-Time Uncertainty Estimation of Autonomous Guided Vehicle Trajectory Taking Into Account Correlated and Uncorrelated Effects. IEEE T. Instrumentation and Measurement, 56(3): , [2] Mariolino De Cecco. Sensor fusion of inertial-odometric navigation as a function of the actual manoeuvres of autonomous guided vehicles. Measurement Science and Technology, 14(5):643, Page 10 of 10

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

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

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

Dealing with Scale. Stephan Weiss Computer Vision Group NASA-JPL / CalTech

Dealing with Scale. Stephan Weiss Computer Vision Group NASA-JPL / CalTech Dealing with Scale Stephan Weiss Computer Vision Group NASA-JPL / CalTech Stephan.Weiss@ieee.org (c) 2013. Government sponsorship acknowledged. Outline Why care about size? The IMU as scale provider: The

More information

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

Colorado School of Mines. Computer Vision. Professor William Hoff Dept of Electrical Engineering &Computer Science.

Colorado School of Mines. Computer Vision. Professor William Hoff Dept of Electrical Engineering &Computer Science. Professor William Hoff Dept of Electrical Engineering &Computer Science http://inside.mines.edu/~whoff/ 1 Bundle Adjustment 2 Example Application A vehicle needs to map its environment that it is moving

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

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

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

Autonomous Navigation in Complex Indoor and Outdoor Environments with Micro Aerial Vehicles

Autonomous Navigation in Complex Indoor and Outdoor Environments with Micro Aerial Vehicles Autonomous Navigation in Complex Indoor and Outdoor Environments with Micro Aerial Vehicles Shaojie Shen Dept. of Electrical and Systems Engineering & GRASP Lab, University of Pennsylvania Committee: Daniel

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

CSE 527: Introduction to Computer Vision

CSE 527: Introduction to Computer Vision CSE 527: Introduction to Computer Vision Week 10 Class 2: Visual Odometry November 2nd, 2017 Today Visual Odometry Intro Algorithm SLAM Visual Odometry Input Output Images, Video Camera trajectory, motion

More information

Robotics. Lecture 7: Simultaneous Localisation and Mapping (SLAM)

Robotics. Lecture 7: Simultaneous Localisation and Mapping (SLAM) Robotics Lecture 7: Simultaneous Localisation and Mapping (SLAM) See course website http://www.doc.ic.ac.uk/~ajd/robotics/ for up to date information. Andrew Davison Department of Computing Imperial College

More information

Visual SLAM. An Overview. L. Freda. ALCOR Lab DIAG University of Rome La Sapienza. May 3, 2016

Visual SLAM. An Overview. L. Freda. ALCOR Lab DIAG University of Rome La Sapienza. May 3, 2016 An Overview L. Freda ALCOR Lab DIAG University of Rome La Sapienza May 3, 2016 L. Freda (University of Rome La Sapienza ) Visual SLAM May 3, 2016 1 / 39 Outline 1 Introduction What is SLAM Motivations

More information

Least Squares and SLAM Pose-SLAM

Least Squares and SLAM Pose-SLAM Least Squares and SLAM Pose-SLAM Giorgio Grisetti Part of the material of this course is taken from the Robotics 2 lectures given by G.Grisetti, W.Burgard, C.Stachniss, K.Arras, D. Tipaldi and M.Bennewitz

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

Humanoid Robotics. Least Squares. Maren Bennewitz

Humanoid Robotics. Least Squares. Maren Bennewitz Humanoid Robotics Least Squares Maren Bennewitz Goal of This Lecture Introduction into least squares Use it yourself for odometry calibration, later in the lecture: camera and whole-body self-calibration

More information

Motion Capture using Body Mounted Cameras in an Unknown Environment

Motion Capture using Body Mounted Cameras in an Unknown Environment Motion Capture using Body Mounted Cameras in an Unknown Environment Nam Vo Taeyoung Kim Siddharth Choudhary 1. The Problem Motion capture has been recently used to provide much of character motion in several

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

Localization, Mapping and Exploration with Multiple Robots. Dr. Daisy Tang

Localization, Mapping and Exploration with Multiple Robots. Dr. Daisy Tang Localization, Mapping and Exploration with Multiple Robots Dr. Daisy Tang Two Presentations A real-time algorithm for mobile robot mapping with applications to multi-robot and 3D mapping, by Thrun, Burgard

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

Robotics. Lecture 8: Simultaneous Localisation and Mapping (SLAM)

Robotics. Lecture 8: Simultaneous Localisation and Mapping (SLAM) Robotics Lecture 8: Simultaneous Localisation and Mapping (SLAM) See course website http://www.doc.ic.ac.uk/~ajd/robotics/ for up to date information. Andrew Davison Department of Computing Imperial College

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

The UTIAS multi-robot cooperative localization and mapping dataset

The UTIAS multi-robot cooperative localization and mapping dataset The UTIAS multi-robot cooperative localization and mapping dataset The International Journal of Robotics Research 30(8) 969 974 The Author(s) 2011 Reprints and permission: sagepub.co.uk/journalspermissions.nav

More information

Monocular Vision for Mobile Robot Localization and Autonomous Navigation

Monocular Vision for Mobile Robot Localization and Autonomous Navigation International Journal of Computer Vision 74(3), 237 260, 2007 c 2007 Springer Science + Business Media, LLC. Manufactured in the United States. DOI: 10.1007/s11263-006-0023-y Monocular Vision for Mobile

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

Advanced Techniques for Mobile Robotics Graph-based SLAM using Least Squares. Wolfram Burgard, Cyrill Stachniss, Kai Arras, Maren Bennewitz

Advanced Techniques for Mobile Robotics Graph-based SLAM using Least Squares. Wolfram Burgard, Cyrill Stachniss, Kai Arras, Maren Bennewitz Advanced Techniques for Mobile Robotics Graph-based SLAM using Least Squares Wolfram Burgard, Cyrill Stachniss, Kai Arras, Maren Bennewitz SLAM Constraints connect the poses of the robot while it is moving

More information

Fundamental problems in mobile robotics

Fundamental problems in mobile robotics ROBOTICS 01PEEQW Basilio Bona DAUIN Politecnico di Torino Mobile & Service Robotics Kinematics Fundamental problems in mobile robotics Locomotion: how the robot moves in the environment Perception: how

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

Dense Tracking and Mapping for Autonomous Quadrocopters. Jürgen Sturm

Dense Tracking and Mapping for Autonomous Quadrocopters. Jürgen Sturm Computer Vision Group Prof. Daniel Cremers Dense Tracking and Mapping for Autonomous Quadrocopters Jürgen Sturm Joint work with Frank Steinbrücker, Jakob Engel, Christian Kerl, Erik Bylow, and Daniel Cremers

More information

Evaluating the Performance of a Vehicle Pose Measurement System

Evaluating the Performance of a Vehicle Pose Measurement System Evaluating the Performance of a Vehicle Pose Measurement System Harry Scott Sandor Szabo National Institute of Standards and Technology Abstract A method is presented for evaluating the performance of

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

Practical Robotics (PRAC)

Practical Robotics (PRAC) Practical Robotics (PRAC) A Mobile Robot Navigation System (1) - Sensor and Kinematic Modelling Nick Pears University of York, Department of Computer Science December 17, 2014 nep (UoY CS) PRAC Practical

More information

Robot Mapping. SLAM Front-Ends. Cyrill Stachniss. Partial image courtesy: Edwin Olson 1

Robot Mapping. SLAM Front-Ends. Cyrill Stachniss. Partial image courtesy: Edwin Olson 1 Robot Mapping SLAM Front-Ends Cyrill Stachniss Partial image courtesy: Edwin Olson 1 Graph-Based SLAM Constraints connect the nodes through odometry and observations Robot pose Constraint 2 Graph-Based

More information

Real-Time Vision-Aided Localization and. Navigation Based on Three-View Geometry

Real-Time Vision-Aided Localization and. Navigation Based on Three-View Geometry Real-Time Vision-Aided Localization and 1 Navigation Based on Three-View Geometry Vadim Indelman, Pini Gurfil, Ehud Rivlin and Hector Rotstein Abstract This paper presents a new method for vision-aided

More information

Simultaneous Localization and Mapping (SLAM)

Simultaneous Localization and Mapping (SLAM) Simultaneous Localization and Mapping (SLAM) RSS Lecture 16 April 8, 2013 Prof. Teller Text: Siegwart and Nourbakhsh S. 5.8 SLAM Problem Statement Inputs: No external coordinate reference Time series of

More information

DYNAMIC POSITIONING OF A MOBILE ROBOT USING A LASER-BASED GONIOMETER. Joaquim A. Batlle*, Josep Maria Font*, Josep Escoda**

DYNAMIC POSITIONING OF A MOBILE ROBOT USING A LASER-BASED GONIOMETER. Joaquim A. Batlle*, Josep Maria Font*, Josep Escoda** DYNAMIC POSITIONING OF A MOBILE ROBOT USING A LASER-BASED GONIOMETER Joaquim A. Batlle*, Josep Maria Font*, Josep Escoda** * Department of Mechanical Engineering Technical University of Catalonia (UPC)

More information

Davide Scaramuzza. University of Zurich

Davide Scaramuzza. University of Zurich Davide Scaramuzza University of Zurich Robotics and Perception Group http://rpg.ifi.uzh.ch/ Scaramuzza, D., Fraundorfer, F., Visual Odometry: Part I - The First 30 Years and Fundamentals, IEEE Robotics

More information

ODOMETRY CORRECTION OF A MOBILE ROBOT USING A RANGE-FINDING LASER. A Thesis Presented to the Graduate School of Clemson University

ODOMETRY CORRECTION OF A MOBILE ROBOT USING A RANGE-FINDING LASER. A Thesis Presented to the Graduate School of Clemson University ODOMETRY CORRECTION OF A MOBILE ROBOT USING A RANGE-FINDING LASER A Thesis Presented to the Graduate School of Clemson University In Partial Fulfillment of the Requirements for the Degree Master of Science

More information

Smoothing and Mapping using Multiple Robots

Smoothing and Mapping using Multiple Robots Smoothing and Mapping using Multiple Robots Karthik Paga (kpaga), Joe Phaneuf (jphaneuf), Adam Driscoll (jdriscol), David Evans (dje1) @cs.cmu.edu arxiv:1805.02141v1 [cs.ro 6 May 2018 Abstract Mapping

More information

Mobile Robots Summery. Autonomous Mobile Robots

Mobile Robots Summery. Autonomous Mobile Robots Mobile Robots Summery Roland Siegwart Mike Bosse, Marco Hutter, Martin Rufli, Davide Scaramuzza, (Margarita Chli, Paul Furgale) Mobile Robots Summery 1 Introduction probabilistic map-based localization

More information

Mobile Robotics. Mathematics, Models, and Methods

Mobile Robotics. Mathematics, Models, and Methods Mobile Robotics Mathematics, Models, and Methods Mobile Robotics offers comprehensive coverage of the essentials of the field suitable for both students and practitioners. Adapted from the author's graduate

More information

Precise indoor localization of multiple mobile robots with adaptive sensor fusion using odometry and vision data

Precise indoor localization of multiple mobile robots with adaptive sensor fusion using odometry and vision data Preprints of the 9th World Congress The International Federation of Automatic Control Cape Town, South Africa. August 4-9, 04 Precise indoor localization of multiple mobile robots with adaptive sensor

More information

arxiv: v1 [cs.cv] 18 Sep 2017

arxiv: v1 [cs.cv] 18 Sep 2017 Direct Pose Estimation with a Monocular Camera Darius Burschka and Elmar Mair arxiv:1709.05815v1 [cs.cv] 18 Sep 2017 Department of Informatics Technische Universität München, Germany {burschka elmar.mair}@mytum.de

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

W4. Perception & Situation Awareness & Decision making

W4. Perception & Situation Awareness & Decision making W4. Perception & Situation Awareness & Decision making Robot Perception for Dynamic environments: Outline & DP-Grids concept Dynamic Probabilistic Grids Bayesian Occupancy Filter concept Dynamic Probabilistic

More information

Aerial Robotic Autonomous Exploration & Mapping in Degraded Visual Environments. Kostas Alexis Autonomous Robots Lab, University of Nevada, Reno

Aerial Robotic Autonomous Exploration & Mapping in Degraded Visual Environments. Kostas Alexis Autonomous Robots Lab, University of Nevada, Reno Aerial Robotic Autonomous Exploration & Mapping in Degraded Visual Environments Kostas Alexis Autonomous Robots Lab, University of Nevada, Reno Motivation Aerial robotic operation in GPS-denied Degraded

More information

Simultaneous Localization

Simultaneous Localization Simultaneous Localization and Mapping (SLAM) RSS Technical Lecture 16 April 9, 2012 Prof. Teller Text: Siegwart and Nourbakhsh S. 5.8 Navigation Overview Where am I? Where am I going? Localization Assumed

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

VISION-BASED MOBILE ROBOT LOCALIZATION WITH SIMPLE ARTIFICIAL LANDMARKS. Robert B aczyk, Andrzej Kasiński, Piotr Skrzypczyński

VISION-BASED MOBILE ROBOT LOCALIZATION WITH SIMPLE ARTIFICIAL LANDMARKS. Robert B aczyk, Andrzej Kasiński, Piotr Skrzypczyński VISION-BASED MOBILE ROBOT LOCALIZATION WITH SIMPLE ARTIFICIAL LANDMARKS Robert B aczyk, Andrzej Kasiński, Piotr Skrzypczyński Poznań University of Technology, Institute of Control and Information Engineering,

More information

F1/10 th Autonomous Racing. Localization. Nischal K N

F1/10 th Autonomous Racing. Localization. Nischal K N F1/10 th Autonomous Racing Localization Nischal K N System Overview Mapping Hector Mapping Localization Path Planning Control System Overview Mapping Hector Mapping Localization Adaptive Monte Carlo Localization

More information

An Efficient Method for Solving the Direct Kinematics of Parallel Manipulators Following a Trajectory

An Efficient Method for Solving the Direct Kinematics of Parallel Manipulators Following a Trajectory An Efficient Method for Solving the Direct Kinematics of Parallel Manipulators Following a Trajectory Roshdy Foaad Abo-Shanab Kafr Elsheikh University/Department of Mechanical Engineering, Kafr Elsheikh,

More information

Computer Vision I - Algorithms and Applications: Multi-View 3D reconstruction

Computer Vision I - Algorithms and Applications: Multi-View 3D reconstruction Computer Vision I - Algorithms and Applications: Multi-View 3D reconstruction Carsten Rother 09/12/2013 Computer Vision I: Multi-View 3D reconstruction Roadmap this lecture Computer Vision I: Multi-View

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

Stable Vision-Aided Navigation for Large-Area Augmented Reality

Stable Vision-Aided Navigation for Large-Area Augmented Reality Stable Vision-Aided Navigation for Large-Area Augmented Reality Taragay Oskiper, Han-Pang Chiu, Zhiwei Zhu Supun Samarasekera, Rakesh Teddy Kumar Vision and Robotics Laboratory SRI-International Sarnoff,

More information

Graph-based SLAM (Simultaneous Localization And Mapping) for Bridge Inspection Using UAV (Unmanned Aerial Vehicle)

Graph-based SLAM (Simultaneous Localization And Mapping) for Bridge Inspection Using UAV (Unmanned Aerial Vehicle) Graph-based SLAM (Simultaneous Localization And Mapping) for Bridge Inspection Using UAV (Unmanned Aerial Vehicle) Taekjun Oh 1), Sungwook Jung 2), Seungwon Song 3), and Hyun Myung 4) 1), 2), 3), 4) Urban

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

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

Appearance-Based Minimalistic Metric SLAM

Appearance-Based Minimalistic Metric SLAM Appearance-Based Minimalistic Metric SLAM Paul E. Rybski, Stergios I. Roumeliotis, Maria Gini, Nikolaos Papanikolopoulos Center for Distributed Robotics Department of Computer Science and Engineering University

More information

StereoScan: Dense 3D Reconstruction in Real-time

StereoScan: Dense 3D Reconstruction in Real-time STANFORD UNIVERSITY, COMPUTER SCIENCE, STANFORD CS231A SPRING 2016 StereoScan: Dense 3D Reconstruction in Real-time Peirong Ji, pji@stanford.edu June 7, 2016 1 INTRODUCTION In this project, I am trying

More information

Stereo Observation Models

Stereo Observation Models Stereo Observation Models Gabe Sibley June 16, 2003 Abstract This technical report describes general stereo vision triangulation and linearized error modeling. 0.1 Standard Model Equations If the relative

More information

GPS denied Navigation Solutions

GPS denied Navigation Solutions GPS denied Navigation Solutions Krishnraj Singh Gaur and Mangal Kothari ksgaur@iitk.ac.in, mangal@iitk.ac.in https://www.iitk.ac.in/aero/mangal/ Intelligent Guidance and Control Laboratory Indian Institute

More information

Sensor fusion methods for indoor navigation using UWB radio aided INS/DR

Sensor fusion methods for indoor navigation using UWB radio aided INS/DR Sensor fusion methods for indoor navigation using UWB radio aided INS/DR JOSÉ BORRÀS SILLERO Master s Degree Project Stockholm, Sweden July 2012 XR-EE-SB 2012:015 Abstract Some applications such as industrial

More information

EE565:Mobile Robotics Lecture 3

EE565:Mobile Robotics Lecture 3 EE565:Mobile Robotics Lecture 3 Welcome Dr. Ahmad Kamal Nasir Today s Objectives Motion Models Velocity based model (Dead-Reckoning) Odometry based model (Wheel Encoders) Sensor Models Beam model of range

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

Information Fusion in Navigation Systems via Factor Graph Based Incremental Smoothing

Information Fusion in Navigation Systems via Factor Graph Based Incremental Smoothing Information Fusion in Navigation Systems via Factor Graph Based Incremental Smoothing Vadim Indelman a, Stephen Williams a, Michael Kaess b, Frank Dellaert a a College of Computing, Georgia Institute of

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

(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

Lost! Leveraging the Crowd for Probabilistic Visual Self-Localization

Lost! Leveraging the Crowd for Probabilistic Visual Self-Localization Lost! Leveraging the Crowd for Probabilistic Visual Self-Localization Marcus A. Brubaker (Toyota Technological Institute at Chicago) Andreas Geiger (Karlsruhe Institute of Technology & MPI Tübingen) Raquel

More information

Theory of Elasticity, Article 18, Generic 2D Stress Distributions

Theory of Elasticity, Article 18, Generic 2D Stress Distributions Theory of Elasticity, Article 18, Generic 2D Stress Distributions One approach to solve 2D continuum problems analytically is to use stress functions. Article 18 of the third edition of Theory of Elasticity

More information

A Lie Algebraic Approach for Consistent Pose Registration for General Euclidean Motion

A Lie Algebraic Approach for Consistent Pose Registration for General Euclidean Motion A Lie Algebraic Approach for Consistent Pose Registration for General Euclidean Motion Motilal Agrawal SRI International 333 Ravenswood Ave. Menlo Park, CA 9425, USA agrawal@ai.sri.com Abstract We study

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

Robot Mapping. Graph-Based SLAM with Landmarks. Cyrill Stachniss

Robot Mapping. Graph-Based SLAM with Landmarks. Cyrill Stachniss Robot Mapping Graph-Based SLAM with Landmarks Cyrill Stachniss 1 Graph-Based SLAM (Chap. 15) Use a graph to represent the problem Every node in the graph corresponds to a pose of the robot during mapping

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

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

Low Cost solution for Pose Estimation of Quadrotor

Low Cost solution for Pose Estimation of Quadrotor Low Cost solution for Pose Estimation of Quadrotor mangal@iitk.ac.in https://www.iitk.ac.in/aero/mangal/ Intelligent Guidance and Control Laboratory Indian Institute of Technology, Kanpur Mangal Kothari

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

Visual Odometry. Features, Tracking, Essential Matrix, and RANSAC. Stephan Weiss Computer Vision Group NASA-JPL / CalTech

Visual Odometry. Features, Tracking, Essential Matrix, and RANSAC. Stephan Weiss Computer Vision Group NASA-JPL / CalTech Visual Odometry Features, Tracking, Essential Matrix, and RANSAC Stephan Weiss Computer Vision Group NASA-JPL / CalTech Stephan.Weiss@ieee.org (c) 2013. Government sponsorship acknowledged. Outline The

More information

E80. Experimental Engineering. Lecture 9 Inertial Measurement

E80. Experimental Engineering. Lecture 9 Inertial Measurement Lecture 9 Inertial Measurement http://www.volker-doormann.org/physics.htm Feb. 19, 2013 Christopher M. Clark Where is the rocket? Outline Sensors People Accelerometers Gyroscopes Representations State

More information

Kalman Filter Based. Localization

Kalman Filter Based. Localization Autonomous Mobile Robots Localization "Position" Global Map Cognition Environment Model Local Map Path Perception Real World Environment Motion Control Kalman Filter Based Localization & SLAM Zürich Autonomous

More information

Encoder applications. I Most common use case: Combination with motors

Encoder applications. I Most common use case: Combination with motors 3.5 Rotation / Motion - Encoder applications 64-424 Intelligent Robotics Encoder applications I Most common use case: Combination with motors I Used to measure relative rotation angle, rotational direction

More information

Fast Planar Surface 3D SLAM Using LIDAR

Fast Planar Surface 3D SLAM Using LIDAR Fast Planar Surface 3D SLAM Using LIDAR Kruno Lenac a,, Andrej Kitanov a, Robert Cupec b, Ivan Petrović a a University of Zagreb, Faculty of Electrical Engineering and Computing, Unska 3, HR- Zagreb, Croatia

More information

EKF Localization and EKF SLAM incorporating prior information

EKF Localization and EKF SLAM incorporating prior information EKF Localization and EKF SLAM incorporating prior information Final Report ME- Samuel Castaneda ID: 113155 1. Abstract In the context of mobile robotics, before any motion planning or navigation algorithm

More information

Asynchronous Multi-Sensor Fusion for 3D Mapping and Localization

Asynchronous Multi-Sensor Fusion for 3D Mapping and Localization Asynchronous Multi-Sensor Fusion for 3D Mapping and Localization Patrick Geneva, Kevin Eckenhoff, and Guoquan Huang Abstract In this paper, we address the problem of 3D mapping and localization of autonomous

More information

A General Framework for Mobile Robot Pose Tracking and Multi Sensors Self-Calibration

A General Framework for Mobile Robot Pose Tracking and Multi Sensors Self-Calibration A General Framework for Mobile Robot Pose Tracking and Multi Sensors Self-Calibration Davide Cucci, Matteo Matteucci {cucci, matteucci}@elet.polimi.it Dipartimento di Elettronica, Informazione e Bioingegneria,

More information

OFERTA O120410PA CURRENT DATE 10/04//2012 VALID UNTIL 10/05/2012 SUMMIT XL

OFERTA O120410PA CURRENT DATE 10/04//2012 VALID UNTIL 10/05/2012 SUMMIT XL OFERTA O120410PA CURRENT DATE 10/04//2012 VALID UNTIL 10/05/2012 SUMMIT XL CLIENT CLIENT: Gaitech REPRESENTANT: Andrew Pether MAIL: andyroojp@hotmail.com PRODUCT Introduction The SUMMIT XL has skid-steering

More information

CVPR 2014 Visual SLAM Tutorial Efficient Inference

CVPR 2014 Visual SLAM Tutorial Efficient Inference CVPR 2014 Visual SLAM Tutorial Efficient Inference kaess@cmu.edu The Robotics Institute Carnegie Mellon University The Mapping Problem (t=0) Robot Landmark Measurement Onboard sensors: Wheel odometry Inertial

More information

Autonomous Vehicle Navigation Using Stereoscopic Imaging

Autonomous Vehicle Navigation Using Stereoscopic Imaging Autonomous Vehicle Navigation Using Stereoscopic Imaging Project Proposal By: Beach Wlaznik Advisors: Dr. Huggins Dr. Stewart December 7, 2006 I. Introduction The objective of the Autonomous Vehicle Navigation

More information

Vision-based Localization of an Underwater Robot in a Structured Environment

Vision-based Localization of an Underwater Robot in a Structured Environment Vision-based Localization of an Underwater Robot in a Structured Environment M. Carreras, P. Ridao, R. Garcia and T. Nicosevici Institute of Informatics and Applications University of Girona Campus Montilivi,

More information

DEAD RECKONING FOR MOBILE ROBOTS USING TWO OPTICAL MICE

DEAD RECKONING FOR MOBILE ROBOTS USING TWO OPTICAL MICE DEAD RECKONING FOR MOBILE ROBOTS USING TWO OPTICAL MICE Andrea Bonarini Matteo Matteucci Marcello Restelli Department of Electronics and Information Politecnico di Milano Piazza Leonardo da Vinci, I-20133,

More information

Towards Gaussian Multi-Robot SLAM for Underwater Robotics

Towards Gaussian Multi-Robot SLAM for Underwater Robotics Towards Gaussian Multi-Robot SLAM for Underwater Robotics Dave Kroetsch davek@alumni.uwaterloo.ca Christoper Clark cclark@mecheng1.uwaterloo.ca Lab for Autonomous and Intelligent Robotics University of

More information

Robotics and Autonomous Systems

Robotics and Autonomous Systems Robotics and Autonomous Systems Lecture 6: Perception/Odometry Terry Payne Department of Computer Science University of Liverpool 1 / 47 Today We ll talk about perception and motor control. 2 / 47 Perception

More information

Robotics and Autonomous Systems

Robotics and Autonomous Systems Robotics and Autonomous Systems Lecture 6: Perception/Odometry Simon Parsons Department of Computer Science University of Liverpool 1 / 47 Today We ll talk about perception and motor control. 2 / 47 Perception

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

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

Incremental Real-time Bundle Adjustment for Multi-camera Systems with Points at Infinity

Incremental Real-time Bundle Adjustment for Multi-camera Systems with Points at Infinity Incremental Real-time Bundle Adjustment for Multi-camera Systems with Points at Infinity Johannes Schneider, Thomas Läbe, Wolfgang Förstner 1 Department of Photogrammetry Institute of Geodesy and Geoinformation

More information

Major project components: Sensors Robot hardware/software integration Kinematic model generation High-level control

Major project components: Sensors Robot hardware/software integration Kinematic model generation High-level control Status update: Path planning/following for a snake Major project components: Sensors Robot hardware/software integration Kinematic model generation High-level control 2. Optical mouse Optical mouse technology

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

Introduction to Autonomous Mobile Robots

Introduction to Autonomous Mobile Robots Introduction to Autonomous Mobile Robots second edition Roland Siegwart, Illah R. Nourbakhsh, and Davide Scaramuzza The MIT Press Cambridge, Massachusetts London, England Contents Acknowledgments xiii

More information