Proprioceptive Navigation, Slip Estimation and Slip Control for Autonomous Wheeled Mobile Robots

Size: px
Start display at page:

Download "Proprioceptive Navigation, Slip Estimation and Slip Control for Autonomous Wheeled Mobile Robots"

Transcription

1 Proprioceptive Navigation, Slip Estimation and Slip Control for Autonomous Wheeled Mobile Robots Martin Seyr Institute of Mechanics and Mechatronics Vienna University of Technology Stefan Jakubek Institute of Mechanics and Mechatronics Vienna University of Technology Abstract For a two-wheeled differentially driven mobile robot a navigation and slip control algorithm is developed. The presented concept for purely proprioceptive navigation combines state estimation via extended Kalman filter from inertial sensor data i.e. gyro and acceleration sensors) and odometric measurements i.e. wheel angular encoders). The advantages of both types of sensors are exploited by selective mixing. Tangential slip detection and side-slip angle measurement enable slip control by transiently overriding a pre-planned trajectory. Experimental results demonstrating the performance of the proposed system are presented. Keywords mobile robot navigation, sensor fusion, slip detection, side-slip angle estimation I. INTRODUCTION Autonomous mobile robot control generally raises three problems: control, navigation and motion planning. The present work concentrates on planar navigation, i.e. estimation of the current position and orientation, and slip control, without any absolute position measurement such as GPS, radio beacons or landmark detection. Only data from acceleration sensors, a gyro-sensor inertial sensors) and wheel encoders odometric sensors) are fused. This is known as proprioceptive navigation or dead reckoning as opposed to exteroceptive navigation. Naturally, the position error is subject to unbounded accumulation. Nevertheless, improved proprioceptive navigation systems help increase the allowable travel distance between absolute position updates, []. The standard method for sensor fusion is extended Kalman filtering EKF), e.g. [2], [3]. An EKF yields an optimal estimate in the sense that the statistical variance of the estimated states is minimised. However, biased measurement produces erroneous estimates. Typical sources of measurement bias are inevitable sensor drift for inertial sensors and inaccuracies of geometric parameters and wheel slip for odometric measurement. To reduce the effect of sensor bias, error models predicting the bias have been developed, [4]; or else it can be estimated and re-calibrated, [5]. To calibrate geometric parameters such as wheel diameter and wheelbase, which are vital to odometric navigation, a statistical method has been developed in [6], [7]. To overcome the effects of wheel slip or bumps causing discontinuous ground contact), which introduces a nonsystematic error into odometry, inertial data is used only transiently during periods where odometric measurement is likely to be unreliable. Aside from these periods, odometric measurement is used exclusively, because it is not affected by drift and has little bias when properly calibrated, [], [8]. In the presented approach both gyro and acceleration sensors are transiently substituted for wheel encoder data when necessary, thus enabling reliable side-slip angle estimation and tangential slip detection and ultimately allowing for slip control. The proposed navigation system is used in conjunction with the predictive trajectory tracking algorithm from [9]. Experimental results show that the combined navigation and control system enables appropriate tracking of highly dynamic trajectories. II. HARDWARE The autonomous robot Tinyphoon [], Fig., has two wheels with rubber tires and two felt shoes, one at the front and one at the rear to stabilise it around the pitch axis. It fits into a cuboid with a 75mm square footprint. The two wheels are supported by ball bearings and powered by two individual DC-motors. Exhibiting a power-mass-ratio of 22.5W/kg, the robot is capable of accelerating far beyond the slip boundary. Its maximum velocity is approximately 4m/s. Fig.. Gyro Enc.R Acc. t n Acc.2 Enc.L Autonomous mini-robot Tinyphoon, The robot is equipped with two single-chip two-axis acceleration sensors measuring tangential and lateral acceleration, /6/$2. c 26 IEEE 9 RAM 26

2 a single-chip gyro sensor and wheel encoders for each side. Therefore, seven measurement channels sampled at the same sampling rate of 2ms are available. An Analog Devices Blackfin DSP running at 6MHz provides sufficient calculation performance to execute both the predictive control algorithm and the navigation system. III. KINEMATICS The kinematics of the unicycle-type mobile robot under consideration of side-slip, Fig. 2, are given by ẋ = v cosϕ + α) =v t cos ϕ v n sin ϕ ẏ = v sinϕ + α) =v t sin ϕ + v n cos ϕ ϕ = ω, ) where x and y denote the inertial coordinates of the robot s center of gravity, ϕ denotes its the inertial attitude angle, α is the side-slip angle, v the effective velocity with components v t and v n and ω denotes the yaw rate. x v L ω y Fig. 2. Kinematics of a two-wheeled mobile robot under consideration of side-slip To calculate the robot s position and orientation x, y and ϕ, estimation of v t, v n and ω and subsequent integration using ) is necessary. IV. COMBINED ODOMETRIC AND INERTIAL NAVIGATION As mentioned in the introduction, the general idea is to use data from inertial sensors rather than data from odometric sensors only during periods where odometry is likely to be unreliable, i.e. when tangential or side-slip occur. The task is therefore to detect these situations. As functions of appropriate criteria, mixing ratios are calculated, by which a combination ranging from purely inertial estimation to purely odometric estimation is defined. In Fig. 3 a complete block diagram of the navigation algorithm is depicted. The system operates at two different sampling times, T N = 2ms primarily for navigation integer sampling instants in the following indicated by k) and T C = 2ms for control sampling instants indicated by K), T C >T N, T C /T N IN +. Some parts of the navigation algorithm are also executed at T C,Fig.3. α v t ϕ v n v R v A. Inertial Navigation by Extended Kalman Filter EKF) The two-stage prediction-update) EKF processes the following sensor data at a sampling time of T N : Accelerometers: Two channels in tangential direction, two channels in lateral direction. The sensors are subject to unknown drift which prohibits purely inertial navigation. Another problem is strong mechanical excitation caused by commotions. Gyro sensor: One channel measuring the yaw rate. Compared to the accelerometers, the drift is marginal, thus providing a very reliable measurement. The state prediction using a nonlinear discrete model is given by ˆx k k = â t,k +ˆv n,k ˆω k â n,k ˆv t,k ˆω k T N + ˆv t,k ˆv n,k ˆω k â t,k â n,k } {{ } ˆx k, 2) where v t, v n, ω and the absolute accelerations a t and a n are chosen as the states. The index k k can be spelled out as prediction of states at instant k, based on data of instant k. The measurement vector is written as y k = ω k a t,k + a t2,k )/2 a n,k + a n2,k )/2, 3) where the arithmetic mean of the two respective acceleration measurements is used to reduce noise variance, thus effectively yielding three measurements instead of five. The prediction of the measurements is then given as ŷ k k = ˆω k k â t,k k â n,k k. 4) The Jacobian of the nonlinear discrete state space representation 2) is calculated as G k k = 5) ˆω k T N ˆv n,k T N T N ˆω k T N ˆv t,k T N T N =, whereas the measurement prediction 4) is linear in the states and therefore a constant measurement matrix C IR 3 5 is obtained. The covariance of the prediction ˆx k k is given by P k k = G k k P k G T k k + Q, 6) where Q IR 5 5 denotes the constant) covariance matrix of the states, whose entries are tuned to be as small as possible

3 Inertial sensors Odometric sensors a t,k, a t2,k EKF O v t,k C, O v t ) K ˆx k Prediction 2), 4), 6) Update 7), 8), 9) Odometry ) C ), 2) Q O v t,k, O ω k P k P k I ω k O ω k â n,k k C, O v t ) K I v n,k I v n,k Mixing 5), 7), 6) C 3 C 3 4) C 2 C 2 3) C,K x, y, ϕ) k ˆx k Integration 2) ˆv K 8) ˆv t, ˆv n, ˆω) K Side-slip estimation 9) α K Slip control 22)-25) Q δ K x, y, ϕ) K ˆv, ˆω) K α K C x ref,k+i δ K Predictive control algorithm Fig. 3. Block diagram, light grey: T N,darkgrey:T C but large enough to ensure convergence. The Kalman gain matrix L K IR 5 3 is obtained by minimization of the trace of the state covariance matrix P k IR 5 5. This calculation is performed at T C to save calculation time, without recognisable deterioration of accuracy. L K = P k k C T CP k k C T + R), 7) where R IR 3 3 is the constant) covariance of the measurements, obtained from sensor manufacturer s data sheets or from analysis of the sensor signals in steady state. Using the Kalman gain matrix L K and the difference between predicted and actual measurement, the states are updated to obtain the final state estimate, x k = x k k + L K y k ŷ k k ). 8) As a last step, the covariance of the updated state estimate P k =I L K C)P k k I L K C) T + L K RL T K 9) is calculated to be used in the next sampling instant. B. Odometry From the encoders, which are free of bias due to their principle of operation, the wheel velocities v R, v L are obtained at relatively low noise. The only source of noise is quantisation due to the finite number of encoder impulses per wheel revolution. Aside from non-systematic errors due to wheel slip, odometric data is generally of very high quality. To obtain tangential velocity v t and yaw rate ω, a purely deterministic geometric transformation is applied, v t,k =v R,k + v L,k )/2 ) ω k =v R,k v L,k )/b, where the geometric parameters wheelbase b and the wheel radius used to transform the wheel angular velocity into the wheel velocities have been calibrated offline using results from [6], [7]. Naturally, from odometric measurement no information about the lateral side-slip-) velocity v n can be obtained. C. Tangential slip detection A batch of T C /T N = samples of sensor data is processed. The average tangential velocity difference of the current batch after an initial reset is calculated by discrete integration of the arithmetic mean of the tangential accelerations upper left index O stands for odometric estimate) v K = T T C/T N N O v t,k O v t,k a t,k + a t2,k ) T ) N, T C 2 k= ) which effectively means that a trend is detected, but not a stationary slip. For the latter, the reliability of the acceleration sensors does not suffice.

4 D. Mixing The final estimate is generated by linear mixing between odometric upper left index O) and inertial upper left index I) estimation. As the criterium for mixing of the tangential velocity v t the tangential slip is used. The mixing parameter is calculated every T C using C,K = pc,k + p), 2) +expa v K b )) }{{} C,K a double sided logsig-function as depicted in Fig. 4. Additionally, C is dynamically relaxed following discrete PT- behavior. Odo. C,K, [-] INS. b d d v K = a d d v K = a v K,[m/s] Fig. 4. Double-sided logsig-function as switch between odometric Odo.) and inertial INS.) navigation The tuning parameters are obtained as follows: a : steepness, chosen as steep as possible, but as flat as necessary to avoid limit cycle behavior. b : threshold, chosen as small as possible, but large enough to exclude faulty slip detection due to acceleration sensor bias. p: discrete PT-pole, chosen as close to zero fast) as possible, but large enough to avoid limit cycle behavior. For the lateral velocity v n, the absolute side-acceleration calculated by the EKF) is used as a criterium, its mixing parameter computed every T N by C 2,k = + expa 2 â n,k k b 2 )), 3) where the parameters a 2 and b 2 are obtained much in the same way as for the tangential velocity. The criterium for yaw-rate mixing is simply the absolute difference between odometric and inertial measurement, [7], [], when the difference becomes too large, odometric measurement is assumed to be unreliable, therefore the mixing parameter is obtained every T N by C 3,k = + expa 3 O ω k I ω k b 3 )) with parameters a 3 and b 3 as above. The linear mixing laws for tangential velocity v t, b 4) O ˆv t,k = C,K v t,k + C,K ) I v t,k 5) and yaw rate ω, O ˆω k = C3,k ω k + C 3,k ) I ω k, 6) are straightforward, whereas the lateral velocity v n, calculated by ˆv n,k = C 2,kˆv n,k q 2 + C 2,k ) I v n,k, 7) is taken fully from EKF when the absolute lateral acceleration is beyond the threshold b 2 but geometrically relaxed towards zero when the lateral acceleration is within the threshold. This is necessary, because from odometry no information about lateral velocity can be obtained, i.e. O v n,k does not exist. Without relaxation, however, frequent crossing of the threshold due to inevitably noisy lateral acceleration would result in frequent reset of the lateral velocity to zero. The factor q 2, <q 2 < of geometric progression is chosen as small as possible but large enough to ensure consistent velocity measurement. The final estimate is fed back to the EKF, which means that the EKF does not work consistently in a strict sense, since its output is overwritten after every sampling instant, Fig. 3. E. Calculation of the side-slip angle The resulting track speed, also needed in the control algorithm [9], is calculated by ˆv K = ˆv t,k 2 +ˆv2 n,k signˆv t,k), 8) implicitly assuming that the side-slip angle does not exceed [ π/2; π/2] a reasonable assumption) by using the signfunction. The side-slip angle is calculated from the velocity components, ) ˆvn,K α K = atan fˆv K, ˆω K ), 9) ˆv t,k and multiplied by a linear validity function fˆv K, ˆω K )= : ˆv K ˆω K < c α ˆv K ˆω K c α d α c α : c α < ˆv K ˆω K < d α : d α < ˆv K ˆω K 2) enforcing the side-slip angle to vanish for low track speed or low curvature, where otherwise no meaningful results can be obtained due to numerical reasons, and the side-slip can reasonably be assumed to be very close to zero. F. Deterministic integration of positions Finally, the positions and orientations are calculated by deterministic integration using a simple-forward-eulerdiscretised representation of ), x k+ = x k +v t,k cos ϕ k v n,k sin ϕ k )T N y k+ = y k +v t,k sin ϕ k + v n,k cos ϕ k )T N ϕ k+ = ϕ k + ω k T N. 2) 2

5 V. SLIP CONTROL The reference input to the predictive control algorithm executed at T C ) [9] consists of future reference positions and orientation up to a prediction horizon. These data are generated by a trajectory planning algorithm upper left index T). A trajectory implicitly contains velocity information as opposed to a path, which is purely geometric. In the case of excessive slip, the slip control can now transiently override the trajectory given by the planning algorithm by interpolating the original trajectory points with a reduced step size nominal ), thus remaining on the same geometric path, but with a certain delay. When no tangential or lateral slip occurs, the step size is increased beyond to re-match the original trajectory. The step size δ K, also based on the previous value δ K to ensure continuity, is computed every T C by δ K = min max δ K δ min + min C,K, ) ) q δ δ min ) ),δ min ),δ max,k, + expa 4 α K b 4 )) 22) where the maximum step size δ max,k is given by δ max > ) : K Π K > c δ δ max,k = : c δ > K Π K > d δ δ rem < ) : d δ > K Π K 23) The position on the preplanned trajectory is then given as Π K+ =Π K + δ K, 24) whereas the nominal integer position on the preplanned trajectory naturally equals K. A number of parameters determine the behavior: δ min < : Minimum step size, determines the reduction of velocity in case of slip, δ max > : Maximum step size, determines how quickly the original trajectory is recovered, q δ : factor of geometric growth of the step size after reduction, if chosen too large, limit cycle behavior results, a 4, b 4 : steepness and threshold for side-slip angle, δ rem < : Step size to match reference trajectory after overshoot, c δ, d δ : Upper/lower threshold for re-matching. The reference positions and orientation finally fed to the predictive control algorithm are obtained by interpolation using C x ref,k+i = T x ref floorπk + iδ K ) ) + 25) ΠK + iδ K floorπ K + iδ K ) ) Txref ceilπk + iδ K ) ) T x ref floorπk + iδ K ) )). Thus the progression of velocities associated with the reference trajectory is expanded or compressed according to δ with equal area, which means that both absolute velocity and velocity gradients acceleration or deceleration) are reduced. Fig. 5 gives an example of how the slip control algorithm reduces the step size in a curve, i.e. follows the geometric path with a certain delay, and subsequently catches up with the original trajectory as soon as the curvature decreases, i.e. the side-slip decays. In the picture, associated trajectory points are connected with an oval. T x ref C x ref Fig. 5. Example for the variation of the step size during detected side-slip or tangential slip and corresponding interpolation of the pre-planned trajectory VI. EXPERIMENTAL RESULTS To demonstrate the performance of the navigation and slip control algorithm, two different trajectories to be tracked have been generated: A corner with linear acceleration and deceleration and a cosine-shaped curvature profile, thus producing large side-accelerations. A square with sinusoidal velocity and yaw rate profiles, demanding high translative accelerations and decelerations. The evaluation of the navigation algorithm was performed using an independent offline video system, enabling accurate position and orientation measurement at a framerate of about 25fps and comparing its data offline i.e. after the experiment) with logged navigation data obtained via an RF-module from the autonomous robot. In Fig. 6 the effect of the slip control algorithm is obvious. Due to high side-acceleration, a side-slip angle builds up, which is estimated with high accuracy. The slip control algorithm reduces the step size. Later, when circumstances are safe in regard to slip, the step size is increased to catch up with the original trajectory. In Fig. 7 the action of the slip control algorithm for tangential wheel slip is demonstrated. In situations, where tangential slip is detected indicated by the black circles), the step size is temporarily reduced. In these situations, also a temporary divergence of the velocity estimate can be observed indicated by the light gray areas), which is a consequence of the finite reaction time of switching between odometric and inertial estimation. Finally, in Fig. 8 the position estimation for corner and square is visualised. VII. CONCLUSION In this paper a navigation, slip estimation and slip control algorithm for an autonomous mobile robot, entirely based on 3

6 α [ ] vt,n [ms ] v t, v t, v n, Slip control Rematching v n, y [m] s 3.5s.5s 2s 4.75s s.5s s.5s Fig. 8. right) x [m] x [m] Posture estimates during tracking of a corner left) and a square δ [-] t [s] Fig. 6. Tangential and lateral velocity and side slip angle estimate and slip control during tracking of a corner, indicates the velocities associated with the reference trajectory proprioceptive sensor data has been presented. The navigation algorithm s governing parameters depend on the employed sensors characteristics but are independent of the robot s physical characteristics mass, dimensions). Experimental results show that navigation with a degree of accuracy of approximately 2.5% position error with reference to absolute trajectory length is possible. Furthermore, slip control is made possible by reliable slip estimation, both lateral and tangential. In turn, slip-control supports accurate navigation, because it limits the periods with excessive slip to very short intervals. vt [ms ] ω [rads ] δ [-] t [s] Fig. 7. Tangential velocity and yaw rate estimation and slip control during tracking of a square, indicates the velocities associated with the reference trajectory ACKNOWLEDGMENT This work was financially supported by the Austrian Science Fund FWF, REFERENCES [] J. Borenstein, L. Feng, Gyrodometry: A new method for combining data from gyros and odometry in mobile robots, in IEEE International Conference on Robotics and Automation, Minneapolis, Minnesota, 25. [2] S.I. Roumeliotis, G.A. Bekey, An Extended Kalman Filter for frequent local and infrequent global sensor data fusion, in SPIE International Symposium on Intelligent Systems and Advanced Manufacturing, 997. [3] Y. Fuke, E. Krotkov, Dead reckoning for a lunar rover on uneven terrain, in IEEE International Conference on Robotics and Automation, Minneapolis, Minnesota, 996. [4] B. Barshan, H. F. Durrant-Whyte, Inertial Navigation Systems for Mobile Robots, IEEE Transactions on Robotics and Automation, no., pp , 995. [5] E. Solda, R. Worst, J. Hertzberg, Poor man s gyro-based localization, in IFAC/EURON Symposium on Intelligent Autonomous Vehicles, Lisboa, Portugal, 24. [6] J. Borenstein, L. Feng, Measurement and Correction of Systematic Odometry Errors in Mobile Robots, IEEE Transactions on Robotics and Automation, no. 2, pp , 996. [7] J. Borenstein, H. R. Everett, L. Feng, Where am I? Sensors and Methods for Mobile Robot Positioning. Technical Report, University of Michigan, 996. [8] R. Mazl, L. Preucil, Sensor data fusion for inertial navigation of trains in GPS-dark areas, Intelligent Vehicles Symposium, 23. Proceedings. IEEE, pp , June 23. [9] M. Seyr, S. Jakubek, Mobile robot predictive trajectory tracking, in ICINCO, Barcelona, Spain, 25. [] Novak, G. and Mahlknecht, S., TINYPHOON - A Tiny Autonomous Mobile Robot, in IEEE ISIE 25 International Symposium on Industrial Electronics 25, Dubrovnik, Croatia, June , pp

Fuzzy Logic Based Nonlinear Kalman Filter Applied to Mobile Robots Modelling

Fuzzy Logic Based Nonlinear Kalman Filter Applied to Mobile Robots Modelling Fuzzy Logic Based Nonlinear Kalman Filter Applied to Mobile Robots Modelling Rodrigo Carrasco Sch. Department of Electrical Engineering Pontificia Universidad Católica de Chile, CHILE E-mail: rax@ing.puc.cl

More information

Stochastic Cloning: A generalized framework for processing relative state measurements

Stochastic Cloning: A generalized framework for processing relative state measurements Stochastic Cloning: A generalized framework for processing relative state measurements Stergios I. Roumeliotis and Joel W. Burdick Division of Engineering and Applied Science California Institute of Technology,

More information

with Application to Autonomous Vehicles

with Application to Autonomous Vehicles Nonlinear with Application to Autonomous Vehicles (Ph.D. Candidate) C. Silvestre (Supervisor) P. Oliveira (Co-supervisor) Institute for s and Robotics Instituto Superior Técnico Portugal January 2010 Presentation

More information

Consistent Triangulation for Mobile Robot Localization Using Discontinuous Angular Measurements

Consistent Triangulation for Mobile Robot Localization Using Discontinuous Angular Measurements Seminar on Mechanical Robotic Systems Centre for Intelligent Machines McGill University Consistent Triangulation for Mobile Robot Localization Using Discontinuous Angular Measurements Josep M. Font Llagunes

More information

Position correction by fusion of estimated position and plane.

Position correction by fusion of estimated position and plane. Position Correction Using Elevation Map for Mobile Robot on Rough Terrain Shintaro UCHIDA Shoichi MAEYAMA Akihisa OHYA Shin'ichi YUTA Intelligent Robot Laboratory University of Tsukuba Tsukuba, 0-8 JAPAN

More information

UAV Navigation: Airborne Inertial SLAM

UAV Navigation: Airborne Inertial SLAM Introduction UAV Navigation: Airborne Inertial SLAM Jonghyuk Kim Faculty of Engineering and Information Technology Australian National University, Australia Salah Sukkarieh ARC Centre of Excellence in

More information

Sensors Fusion for Mobile Robotics localization. M. De Cecco - Robotics Perception and Action

Sensors Fusion for Mobile Robotics localization. M. De Cecco - Robotics Perception and Action Sensors Fusion for Mobile Robotics localization 1 Until now we ve presented the main principles and features of incremental and absolute (environment referred localization systems) could you summarize

More information

Automated Tuning of the Nonlinear Complementary Filter for an Attitude Heading Reference Observer

Automated Tuning of the Nonlinear Complementary Filter for an Attitude Heading Reference Observer Automated Tuning of the Nonlinear Complementary Filter for an Attitude Heading Reference Observer Oscar De Silva, George K.I. Mann and Raymond G. Gosine Faculty of Engineering and Applied Sciences, Memorial

More information

Sensor Fusion of Inertial-Odometric Navigation as a Function of the Actual Manoeuvres of Autonomous Guided Vehicles

Sensor Fusion of Inertial-Odometric Navigation as a Function of the Actual Manoeuvres of Autonomous Guided Vehicles Sensor Fusion of Inertial-Odometric Navigation as a Function of the Actual Manoeuvres of Autonomous Guided Vehicles Mariolino De Cecco Address: CISAS, Centre of Studies and Activities for Space, Via Venezia

More information

Vlad Estivill-Castro (2016) Robots for People --- A project for intelligent integrated systems

Vlad Estivill-Castro (2016) Robots for People --- A project for intelligent integrated systems 1 Vlad Estivill-Castro (2016) Robots for People --- A project for intelligent integrated systems V. Estivill-Castro 2 Uncertainty representation Localization Chapter 5 (textbook) What is the course about?

More information

Controller Design and Position Estimation of a Unicycle Type Robot

Controller Design and Position Estimation of a Unicycle Type Robot Department of Mathematics and Computer Science Architecture of Information Systems Research Group Controller Design and Position Estimation of a Unicycle Type Robot Internship report Aniket Sharma DC 2017.015

More information

Localización Dinámica de Robots Móviles Basada en Filtrado de Kalman y Triangulación

Localización Dinámica de Robots Móviles Basada en Filtrado de Kalman y Triangulación Universidad Pública de Navarra 13 de Noviembre de 2008 Departamento de Ingeniería Mecánica, Energética y de Materiales Localización Dinámica de Robots Móviles Basada en Filtrado de Kalman y Triangulación

More information

Mobile Robots Localization

Mobile Robots Localization Mobile Robots Localization Institute for Software Technology 1 Today s Agenda Motivation for Localization Odometry Odometry Calibration Error Model 2 Robotics is Easy control behavior perception modelling

More information

Collective Localization: A distributed Kalman lter approach to. Institute for Robotics and Intelligent Systems

Collective Localization: A distributed Kalman lter approach to. Institute for Robotics and Intelligent Systems Collective Localization: A distributed Kalman lter approach to localization of groups of mobile robots Stergios I. Roumeliotis 1y and George A. Bekey 1 2 stergiosjbekey@robotics:usc:edu 1 Department of

More information

EE Mobile Robots

EE Mobile Robots Electric Electronic Engineering Bogazici University December 27, 2017 Introduction Motion Sensing Absolute position measurement Environmental Sensing Introduction Motion Sensing Environmental Sensing Robot

More information

A Deterministic Filter for Simultaneous Localization and Odometry Calibration of Differential-Drive Mobile Robots

A Deterministic Filter for Simultaneous Localization and Odometry Calibration of Differential-Drive Mobile Robots 1 A Deterministic Filter for Simultaneous Localization and Odometry Calibration of Differential-Drive Mobile Robots Gianluca Antonelli Stefano Chiaverini Dipartimento di Automazione, Elettromagnetismo,

More information

VEHICLE WHEEL-GROUND CONTACT ANGLE ESTIMATION: WITH APPLICATION TO MOBILE ROBOT TRACTION CONTROL

VEHICLE WHEEL-GROUND CONTACT ANGLE ESTIMATION: WITH APPLICATION TO MOBILE ROBOT TRACTION CONTROL 1/10 IAGNEMMA AND DUBOWSKY VEHICLE WHEEL-GROUND CONTACT ANGLE ESTIMATION: WITH APPLICATION TO MOBILE ROBOT TRACTION CONTROL K. IAGNEMMA S. DUBOWSKY Massachusetts Institute of Technology, Cambridge, MA

More information

Control of Mobile Robots

Control of Mobile Robots Control of Mobile Robots Regulation and trajectory tracking Prof. Luca Bascetta (luca.bascetta@polimi.it) Politecnico di Milano Dipartimento di Elettronica, Informazione e Bioingegneria Organization and

More information

Adaptive Unscented Kalman Filter with Multiple Fading Factors for Pico Satellite Attitude Estimation

Adaptive Unscented Kalman Filter with Multiple Fading Factors for Pico Satellite Attitude Estimation Adaptive Unscented Kalman Filter with Multiple Fading Factors for Pico Satellite Attitude Estimation Halil Ersin Söken and Chingiz Hajiyev Aeronautics and Astronautics Faculty Istanbul Technical University

More information

ALARGE number of applications require robots to move in

ALARGE number of applications require robots to move in IEEE TRANSACTIONS ON ROBOTICS, VOL. 22, NO. 5, OCTOBER 2006 917 Optimal Sensor Scheduling for Resource-Constrained Localization of Mobile Robot Formations Anastasios I. Mourikis, Student Member, IEEE,

More information

1 Kalman Filter Introduction

1 Kalman Filter Introduction 1 Kalman Filter Introduction You should first read Chapter 1 of Stochastic models, estimation, and control: Volume 1 by Peter S. Maybec (available here). 1.1 Explanation of Equations (1-3) and (1-4) Equation

More information

Simultaneous Localization and Map Building Using Natural features in Outdoor Environments

Simultaneous Localization and Map Building Using Natural features in Outdoor Environments Simultaneous Localization and Map Building Using Natural features in Outdoor Environments Jose Guivant, Eduardo Nebot, Hugh Durrant Whyte Australian Centre for Field Robotics Department of Mechanical and

More information

Fundamentals of attitude Estimation

Fundamentals of attitude Estimation Fundamentals of attitude Estimation Prepared by A.Kaviyarasu Assistant Professor Department of Aerospace Engineering Madras Institute Of Technology Chromepet, Chennai Basically an IMU can used for two

More information

An Adaptive Filter for a Small Attitude and Heading Reference System Using Low Cost Sensors

An Adaptive Filter for a Small Attitude and Heading Reference System Using Low Cost Sensors An Adaptive Filter for a Small Attitude and eading Reference System Using Low Cost Sensors Tongyue Gao *, Chuntao Shen, Zhenbang Gong, Jinjun Rao, and Jun Luo Department of Precision Mechanical Engineering

More information

Draft 01PC-73 Sensor fusion for accurate computation of yaw rate and absolute velocity

Draft 01PC-73 Sensor fusion for accurate computation of yaw rate and absolute velocity Draft PC-73 Sensor fusion for accurate computation of yaw rate and absolute velocity Fredrik Gustafsson Department of Electrical Engineering, Linköping University, Sweden Stefan Ahlqvist, Urban Forssell,

More information

Control of a Car-Like Vehicle with a Reference Model and Particularization

Control of a Car-Like Vehicle with a Reference Model and Particularization Control of a Car-Like Vehicle with a Reference Model and Particularization Luis Gracia Josep Tornero Department of Systems and Control Engineering Polytechnic University of Valencia Camino de Vera s/n,

More information

been developed to calibrate for systematic errors of a two wheel robot. This method has been used by other authors (Chong, 1997). Goel, Roumeliotis an

been developed to calibrate for systematic errors of a two wheel robot. This method has been used by other authors (Chong, 1997). Goel, Roumeliotis an MODELING AND ESTIMATING THE ODOMETRY ERROR OF A MOBILE ROBOT Agostino Martinelli Λ Λ Dipartimento di Informatica, Sistemi e Produzione, Universit a degli Studi di Roma Tor Vergata", Via di Tor Vergata,

More information

Institute for Robotics and Intelligent Systems Los Angeles, CA

Institute for Robotics and Intelligent Systems Los Angeles, CA Sensor Fault Detection and Identication in a Mobile Robot Stergios I. Roumeliotis, Gaurav S. Sukhatme y and George A. Bekey stergiosjgauravjbekey@robotics:usc:edu Department of Computer Science Institute

More information

Location Estimation using Delayed Measurements

Location Estimation using Delayed Measurements Downloaded from orbit.dtu.dk on: Jan 29, 2019 Location Estimation using Delayed Measurements Bak, Martin; Larsen, Thomas Dall; Nørgård, Peter Magnus; Andersen, Nils Axel; Poulsen, Niels Kjølstad; Ravn,

More information

Modeling Verticality Estimation During Locomotion

Modeling Verticality Estimation During Locomotion Proceedings of the 19th CISM-IFToMM Symposium on Robot Design, Dynamics, and Control, Romansy 212. pp. 651-656 Modeling Verticality Estimation During Locomotion Ildar Farkhatdinov 1 Hannah Michalska 2

More information

EXPERIMENTAL COMPARISON OF TRAJECTORY TRACKERS FOR A CAR WITH TRAILERS

EXPERIMENTAL COMPARISON OF TRAJECTORY TRACKERS FOR A CAR WITH TRAILERS 1996 IFAC World Congress San Francisco, July 1996 EXPERIMENTAL COMPARISON OF TRAJECTORY TRACKERS FOR A CAR WITH TRAILERS Francesco Bullo Richard M. Murray Control and Dynamical Systems, California Institute

More information

Multi-layer Flight Control Synthesis and Analysis of a Small-scale UAV Helicopter

Multi-layer Flight Control Synthesis and Analysis of a Small-scale UAV Helicopter Multi-layer Flight Control Synthesis and Analysis of a Small-scale UAV Helicopter Ali Karimoddini, Guowei Cai, Ben M. Chen, Hai Lin and Tong H. Lee Graduate School for Integrative Sciences and Engineering,

More information

Improving estimations of a robot s position and attitude w ith accelerom eter enhanced odometry

Improving estimations of a robot s position and attitude w ith accelerom eter enhanced odometry 4 2 Vol. 4. 2 2009 4 CAA I Transactions on Intelligent System s Ap r. 2009 1, 2, 3 (1., 100094 2., 150080 3. 304 2, 046012) :,,. Gyrodometry,,,,,. 1 /3, 1 /6,. : Gyrodometry : TP242 : A : 167324785 (2009)

More information

Inertial Odometry on Handheld Smartphones

Inertial Odometry on Handheld Smartphones Inertial Odometry on Handheld Smartphones Arno Solin 1 Santiago Cortés 1 Esa Rahtu 2 Juho Kannala 1 1 Aalto University 2 Tampere University of Technology 21st International Conference on Information Fusion

More information

Cinematica dei Robot Mobili su Ruote. Corso di Robotica Prof. Davide Brugali Università degli Studi di Bergamo

Cinematica dei Robot Mobili su Ruote. Corso di Robotica Prof. Davide Brugali Università degli Studi di Bergamo Cinematica dei Robot Mobili su Ruote Corso di Robotica Prof. Davide Brugali Università degli Studi di Bergamo Riferimenti bibliografici Roland SIEGWART, Illah R. NOURBAKHSH Introduction to Autonomous Mobile

More information

Lego NXT: Navigation and localization using infrared distance sensors and Extended Kalman Filter. Miguel Pinto, A. Paulo Moreira, Aníbal Matos

Lego NXT: Navigation and localization using infrared distance sensors and Extended Kalman Filter. Miguel Pinto, A. Paulo Moreira, Aníbal Matos Lego NXT: Navigation and localization using infrared distance sensors and Extended Kalman Filter Miguel Pinto, A. Paulo Moreira, Aníbal Matos 1 Resume LegoFeup Localization Real and simulated scenarios

More information

arxiv: v1 [cs.ro] 6 Mar 2018

arxiv: v1 [cs.ro] 6 Mar 2018 Robust using Sensor Consensus Analysis Andrew W. Palmer and Navid Nourani-Vatani arxiv:183.2237v1 [cs.ro] 6 Mar 218 Abstract forms an important component of many manned and autonomous systems. In the rail

More information

EEE 187: Take Home Test #2

EEE 187: Take Home Test #2 EEE 187: Take Home Test #2 Date: 11/30/2017 Due : 12/06/2017 at 5pm 1 Please read. Two versions of the exam are proposed. You need to solve one only. Version A: Four problems, Python is required for some

More information

Distributed Intelligent Systems W4 An Introduction to Localization Methods for Mobile Robots

Distributed Intelligent Systems W4 An Introduction to Localization Methods for Mobile Robots Distributed Intelligent Systems W4 An Introduction to Localization Methods for Mobile Robots 1 Outline Positioning systems Indoor Outdoor Robot localization using proprioceptive sensors without uncertainties

More information

Lecture 9: Modeling and motion models

Lecture 9: Modeling and motion models Sensor Fusion, 2014 Lecture 9: 1 Lecture 9: Modeling and motion models Whiteboard: Principles and some examples. Slides: Sampling formulas. Noise models. Standard motion models. Position as integrated

More information

Rao-Blackwellized Particle Filtering for 6-DOF Estimation of Attitude and Position via GPS and Inertial Sensors

Rao-Blackwellized Particle Filtering for 6-DOF Estimation of Attitude and Position via GPS and Inertial Sensors Rao-Blackwellized Particle Filtering for 6-DOF Estimation of Attitude and Position via GPS and Inertial Sensors GRASP Laboratory University of Pennsylvania June 6, 06 Outline Motivation Motivation 3 Problem

More information

NAVIGATION OF THE WHEELED TRANSPORT ROBOT UNDER MEASUREMENT NOISE

NAVIGATION OF THE WHEELED TRANSPORT ROBOT UNDER MEASUREMENT NOISE WMS J. Pure Appl. Math. V.7, N.1, 2016, pp.20-27 NAVIGAION OF HE WHEELED RANSPOR ROBO UNDER MEASUREMEN NOISE VLADIMIR LARIN 1 Abstract. he problem of navigation of the simple wheeled transport robot is

More information

A First-Estimates Jacobian EKF for Improving SLAM Consistency

A First-Estimates Jacobian EKF for Improving SLAM Consistency A First-Estimates Jacobian EKF for Improving SLAM Consistency Guoquan P. Huang 1, Anastasios I. Mourikis 1,2, and Stergios I. Roumeliotis 1 1 Dept. of Computer Science and Engineering, University of Minnesota,

More information

Silicon Capacitive Accelerometers. Ulf Meriheinä M.Sc. (Eng.) Business Development Manager VTI TECHNOLOGIES

Silicon Capacitive Accelerometers. Ulf Meriheinä M.Sc. (Eng.) Business Development Manager VTI TECHNOLOGIES Silicon Capacitive Accelerometers Ulf Meriheinä M.Sc. (Eng.) Business Development Manager VTI TECHNOLOGIES 1 Measuring Acceleration The acceleration measurement is based on Newton s 2nd law: Let the acceleration

More information

ESTIMATOR STABILITY ANALYSIS IN SLAM. Teresa Vidal-Calleja, Juan Andrade-Cetto, Alberto Sanfeliu

ESTIMATOR STABILITY ANALYSIS IN SLAM. Teresa Vidal-Calleja, Juan Andrade-Cetto, Alberto Sanfeliu ESTIMATOR STABILITY ANALYSIS IN SLAM Teresa Vidal-Calleja, Juan Andrade-Cetto, Alberto Sanfeliu Institut de Robtica i Informtica Industrial, UPC-CSIC Llorens Artigas 4-6, Barcelona, 88 Spain {tvidal, cetto,

More information

Joint GPS and Vision Estimation Using an Adaptive Filter

Joint GPS and Vision Estimation Using an Adaptive Filter 1 Joint GPS and Vision Estimation Using an Adaptive Filter Shubhendra Vikram Singh Chauhan and Grace Xingxin Gao, University of Illinois at Urbana-Champaign Shubhendra Vikram Singh Chauhan received his

More information

Quaternion based Extended Kalman Filter

Quaternion based Extended Kalman Filter Quaternion based Extended Kalman Filter, Sergio Montenegro About this lecture General introduction to rotations and quaternions. Introduction to Kalman Filter for Attitude Estimation How to implement and

More information

Aiding Off-Road Inertial Navigation with High Performance Models of Wheel Slip

Aiding Off-Road Inertial Navigation with High Performance Models of Wheel Slip Aiding Off-Road Inertial Navigation with High Performance Models of Wheel Slip Forrest Rogers-Marcovitz, Michael George, Neal Seegmiller, and Alonzo Kelly Abstract When GPS, or other absolute positioning,

More information

Multi-Sensor Fusion for Localization of a Mobile Robot in Outdoor Environments

Multi-Sensor Fusion for Localization of a Mobile Robot in Outdoor Environments Multi-Sensor Fusion for Localization of a Mobile Robot in Outdoor Environments Thomas Emter, Arda Saltoğlu and Janko Petereit Introduction AMROS Mobile platform equipped with multiple sensors for navigation

More information

VN-100 Velocity Compensation

VN-100 Velocity Compensation VN-100 Velocity Compensation Velocity / Airspeed Aiding for AHRS Applications Application Note Abstract This application note describes how the VN-100 can be used in non-stationary applications which require

More information

EE565:Mobile Robotics Lecture 6

EE565:Mobile Robotics Lecture 6 EE565:Mobile Robotics Lecture 6 Welcome Dr. Ahmad Kamal Nasir Announcement Mid-Term Examination # 1 (25%) Understand basic wheel robot kinematics, common mobile robot sensors and actuators knowledge. Understand

More information

Fuzzy Adaptive Kalman Filtering for INS/GPS Data Fusion

Fuzzy Adaptive Kalman Filtering for INS/GPS Data Fusion A99936769 AMA-99-4307 Fuzzy Adaptive Kalman Filtering for INS/GPS Data Fusion J.Z. Sasiadek* and Q. Wang** Dept. of Mechanical & Aerospace Engineering Carleton University 1125 Colonel By Drive, Ottawa,

More information

TYRE STATE ESTIMATION. Antoine Schmeitz, Arjan Teerhuis, Laura van de Molengraft-Luijten

TYRE STATE ESTIMATION. Antoine Schmeitz, Arjan Teerhuis, Laura van de Molengraft-Luijten Antoine Schmeitz, Arjan Teerhuis, Laura van de Molengraft-Luijten CONTENTS Introduction Experimental setup Basic shape model Tyre state estimator Results Concluding remarks Next steps INTRODUCTION Intelligent

More information

MODELLING ANALYSIS & DESIGN OF DSP BASED NOVEL SPEED SENSORLESS VECTOR CONTROLLER FOR INDUCTION MOTOR DRIVE

MODELLING ANALYSIS & DESIGN OF DSP BASED NOVEL SPEED SENSORLESS VECTOR CONTROLLER FOR INDUCTION MOTOR DRIVE International Journal of Advanced Research in Engineering and Technology (IJARET) Volume 6, Issue 3, March, 2015, pp. 70-81, Article ID: IJARET_06_03_008 Available online at http://www.iaeme.com/ijaret/issues.asp?jtypeijaret&vtype=6&itype=3

More information

Location Uncertainty A Probabilistic Solution For Automatic Train Control SUMMARY 1 INTRODUCTION

Location Uncertainty A Probabilistic Solution For Automatic Train Control SUMMARY 1 INTRODUCTION Location Uncertainty A Probabilistic Solution For Automatic Train Control Monish Sengupta, Principal Consultant, Ricardo Rail Professor Benjamin Heydecker, University College London Dr. Daniel Woodland,

More information

Predicting the Performance of Cooperative Simultaneous Localization and Mapping (C-SLAM)

Predicting the Performance of Cooperative Simultaneous Localization and Mapping (C-SLAM) 1 Predicting the Performance of Cooperative Simultaneous Localization and Mapping (C-SLAM) Anastasios I. Mourikis and Stergios I. Roumeliotis Dept. of Computer Science & Engineering, University of Minnesota,

More information

EXPERIMENTAL ANALYSIS OF COLLECTIVE CIRCULAR MOTION FOR MULTI-VEHICLE SYSTEMS. N. Ceccarelli, M. Di Marco, A. Garulli, A.

EXPERIMENTAL ANALYSIS OF COLLECTIVE CIRCULAR MOTION FOR MULTI-VEHICLE SYSTEMS. N. Ceccarelli, M. Di Marco, A. Garulli, A. EXPERIMENTAL ANALYSIS OF COLLECTIVE CIRCULAR MOTION FOR MULTI-VEHICLE SYSTEMS N. Ceccarelli, M. Di Marco, A. Garulli, A. Giannitrapani DII - Dipartimento di Ingegneria dell Informazione Università di Siena

More information

Reduced Sigma Point Filters for the Propagation of Means and Covariances Through Nonlinear Transformations

Reduced Sigma Point Filters for the Propagation of Means and Covariances Through Nonlinear Transformations 1 Reduced Sigma Point Filters for the Propagation of Means and Covariances Through Nonlinear Transformations Simon J. Julier Jeffrey K. Uhlmann IDAK Industries 91 Missouri Blvd., #179 Dept. of Computer

More information

ESTIMATION OF THE LONGITUDINAL AND LATERAL VELOCITIES OF A VEHICLE USING EXTENDED KALMAN FILTERS

ESTIMATION OF THE LONGITUDINAL AND LATERAL VELOCITIES OF A VEHICLE USING EXTENDED KALMAN FILTERS ESTIMATION OF THE LONGITUDINAL AND LATERAL VELOCITIES OF A VEHICLE USING EXTENDED KALMAN FILTERS A Thesis Presented to The Academic Faculty by Juan Camilo Alvarez In Partial Fulfillment of the Requirements

More information

IMU-Camera Calibration: Observability Analysis

IMU-Camera Calibration: Observability Analysis IMU-Camera Calibration: Observability Analysis Faraz M. Mirzaei and Stergios I. Roumeliotis {faraz stergios}@cs.umn.edu Dept. of Computer Science & Engineering University of Minnesota Minneapolis, MN 55455

More information

Miscellaneous. Regarding reading materials. Again, ask questions (if you have) and ask them earlier

Miscellaneous. Regarding reading materials. Again, ask questions (if you have) and ask them earlier Miscellaneous Regarding reading materials Reading materials will be provided as needed If no assigned reading, it means I think the material from class is sufficient Should be enough for you to do your

More information

Mobile Robot Geometry Initialization from Single Camera

Mobile Robot Geometry Initialization from Single Camera Author manuscript, published in "6th International Conference on Field and Service Robotics - FSR 2007, Chamonix : France (2007)" Mobile Robot Geometry Initialization from Single Camera Daniel Pizarro

More information

Chapter 7 Control. Part Classical Control. Mobile Robotics - Prof Alonzo Kelly, CMU RI

Chapter 7 Control. Part Classical Control. Mobile Robotics - Prof Alonzo Kelly, CMU RI Chapter 7 Control 7.1 Classical Control Part 1 1 7.1 Classical Control Outline 7.1.1 Introduction 7.1.2 Virtual Spring Damper 7.1.3 Feedback Control 7.1.4 Model Referenced and Feedforward Control Summary

More information

Control of Mobile Robots Prof. Luca Bascetta

Control of Mobile Robots Prof. Luca Bascetta Control of Mobile Robots Prof. Luca Bascetta EXERCISE 1 1. Consider a wheel rolling without slipping on the horizontal plane, keeping the sagittal plane in the vertical direction. Write the expression

More information

Cross-Coupling Control for Slippage Minimization of a Four-Wheel-Steering Mobile Robot

Cross-Coupling Control for Slippage Minimization of a Four-Wheel-Steering Mobile Robot Cross-Coupling Control for Slippage Minimization of a Four-Wheel-Steering Mobile Robot Maxim Makatchev Dept. of Manufacturing Engineering and Engineering Management City University of Hong Kong Hong Kong

More information

Delayed Fusion of Relative State Measurements by Extending Stochastic Cloning via Direct Kalman Filtering

Delayed Fusion of Relative State Measurements by Extending Stochastic Cloning via Direct Kalman Filtering Delayed Fusion of Relative State Measurements by Extending Stochastic Cloning via Direct Kalman Filtering Ehsan Asadi and Carlo L Bottasso Department of Aerospace Science and echnology Politecnico di Milano,

More information

Robot Localisation. Henrik I. Christensen. January 12, 2007

Robot Localisation. Henrik I. Christensen. January 12, 2007 Robot Henrik I. Robotics and Intelligent Machines @ GT College of Computing Georgia Institute of Technology Atlanta, GA hic@cc.gatech.edu January 12, 2007 The Robot Structure Outline 1 2 3 4 Sum of 5 6

More information

CONTROL DESIGN FOR AN OVERACTUATED WHEELED MOBILE ROBOT. Jeroen Ploeg John P.M. Vissers Henk Nijmeijer

CONTROL DESIGN FOR AN OVERACTUATED WHEELED MOBILE ROBOT. Jeroen Ploeg John P.M. Vissers Henk Nijmeijer CONTROL DESIGN FOR AN OVERACTUATED WHEELED MOBILE ROBOT Jeroen Ploeg John PM Vissers Henk Nijmeijer TNO Automotive, PO Box 756, 57 AT Helmond, The Netherlands, Phone: +31 ()492 566 536, E-mail: jeroenploeg@tnonl

More information

Tactical Ballistic Missile Tracking using the Interacting Multiple Model Algorithm

Tactical Ballistic Missile Tracking using the Interacting Multiple Model Algorithm Tactical Ballistic Missile Tracking using the Interacting Multiple Model Algorithm Robert L Cooperman Raytheon Co C 3 S Division St Petersburg, FL Robert_L_Cooperman@raytheoncom Abstract The problem of

More information

Particle Filters; Simultaneous Localization and Mapping (Intelligent Autonomous Robotics) Subramanian Ramamoorthy School of Informatics

Particle Filters; Simultaneous Localization and Mapping (Intelligent Autonomous Robotics) Subramanian Ramamoorthy School of Informatics Particle Filters; Simultaneous Localization and Mapping (Intelligent Autonomous Robotics) Subramanian Ramamoorthy School of Informatics Recap: State Estimation using Kalman Filter Project state and error

More information

Development of an Extended Operational States Observer of a Power Assist Wheelchair

Development of an Extended Operational States Observer of a Power Assist Wheelchair Development of an Extended Operational States Observer of a Power Assist Wheelchair Sehoon Oh Institute of Industrial Science Universit of Toko 4-6-, Komaba, Meguro, Toko, 53-855 Japan sehoon@horilab.iis.u-toko.ac.jp

More information

IMPROVING VISUAL ODOMETRY PERFORMANCES VIA ADDITIONAL IMAGE PROCESSING AND MULTI-SENSOR INTEGRATION

IMPROVING VISUAL ODOMETRY PERFORMANCES VIA ADDITIONAL IMAGE PROCESSING AND MULTI-SENSOR INTEGRATION IMPROVING VISUAL ODOMETRY PERFORMANCES VIA ADDITIONAL IMAGE PROCESSING AND MULTI-SENSOR INTEGRATION G. Casalino, E. Zereik, E. Simetti, A. Turetta, S. Torelli, and A. Sperindé DIST, University of Genoa,

More information

CS491/691: Introduction to Aerial Robotics

CS491/691: Introduction to Aerial Robotics CS491/691: Introduction to Aerial Robotics Topic: Midterm Preparation Dr. Kostas Alexis (CSE) Areas of Focus Coordinate system transformations (CST) MAV Dynamics (MAVD) Navigation Sensors (NS) State Estimation

More information

Position Control Using Acceleration- Based Identification and Feedback With Unknown Measurement Bias

Position Control Using Acceleration- Based Identification and Feedback With Unknown Measurement Bias Position Control Using Acceleration- Based Identification and Feedback With Unknown Measurement Bias Jaganath Chandrasekar e-mail: jchandra@umich.edu Dennis S. Bernstein e-mail: dsbaero@umich.edu Department

More information

Real-Time Obstacle Avoidance for trailer-like Systems

Real-Time Obstacle Avoidance for trailer-like Systems Real-Time Obstacle Avoidance for trailer-like Systems T.A. Vidal-Calleja, M. Velasco-Villa,E.Aranda-Bricaire. Departamento de Ingeniería Eléctrica, Sección de Mecatrónica, CINVESTAV-IPN, A.P. 4-74, 7,

More information

Predictive Control of Gyroscopic-Force Actuators for Mechanical Vibration Damping

Predictive Control of Gyroscopic-Force Actuators for Mechanical Vibration Damping ARC Centre of Excellence for Complex Dynamic Systems and Control, pp 1 15 Predictive Control of Gyroscopic-Force Actuators for Mechanical Vibration Damping Tristan Perez 1, 2 Joris B Termaat 3 1 School

More information

Autonomous Navigation, Guidance and Control of Small 4-wheel Electric Vehicle

Autonomous Navigation, Guidance and Control of Small 4-wheel Electric Vehicle Journal of Asian Electric Vehicles, Volume 10, Number 1, June 01 Autonomous Navigation, Guidance and Control of Small 4-wheel Electric Vehicle Satoshi Suzuki International Young Researchers Empowerment

More information

Measurement Observers for Pose Estimation on SE(3)

Measurement Observers for Pose Estimation on SE(3) Measurement Observers for Pose Estimation on SE(3) By Geoffrey Stacey u4308250 Supervised by Prof. Robert Mahony 24 September 2010 A thesis submitted in part fulfilment of the degree of Bachelor of Engineering

More information

Information Exchange in Multi-rover SLAM

Information Exchange in Multi-rover SLAM nformation Exchange in Multi-rover SLAM Brandon M Jones and Lang Tong School of Electrical and Computer Engineering Cornell University, thaca, NY 53 {bmj3,lt35}@cornelledu Abstract We investigate simultaneous

More information

Discrete Time-Varying Attitude Complementary Filter

Discrete Time-Varying Attitude Complementary Filter 29 American Control Conference Hyatt Regency Riverfront, St. Louis, MO, USA June 1-12, 29 FrA4.2 Discrete Time-Varying Attitude Complementary Filter J.F. Vasconcelos, C. Silvestre, P. Oliveira, P. Batista,

More information

The Unicycle in Presence of a Single Disturbance: Observability Properties

The Unicycle in Presence of a Single Disturbance: Observability Properties The Unicycle in Presence of a Single Disturbance: Observability Properties Agostino Martinelli To cite this version: Agostino Martinelli. The Unicycle in Presence of a Single Disturbance: Observability

More information

One Approach to the Integration of Inertial and Visual Navigation Systems

One Approach to the Integration of Inertial and Visual Navigation Systems FATA UNIVERSITATIS (NIŠ) SER.: ELE. ENERG. vol. 18, no. 3, December 2005, 479-491 One Approach to the Integration of Inertial and Visual Navigation Systems Dedicated to Professor Milić Stojić on the occasion

More information

Estimation and Control of a Quadrotor Attitude

Estimation and Control of a Quadrotor Attitude Estimation and Control of a Quadrotor Attitude Bernardo Sousa Machado Henriques Mechanical Engineering Department, Instituto Superior Técnico, Lisboa, Portugal E-mail: henriquesbernardo@gmail.com Abstract

More information

How Sensor Graph Topology Affects Localization Accuracy

How Sensor Graph Topology Affects Localization Accuracy How Sensor Graph Topology Affects Localization Accuracy Deepti Kumar and Herbert G. Tanner Abstract We characterize the accuracy of a cooperative localization algorithm based on Kalman Filtering, as expressed

More information

Accurate Odometry and Error Modelling for a Mobile Robot

Accurate Odometry and Error Modelling for a Mobile Robot Accurate Odometry and Error Modelling for a Mobile Robot Ko Seng CHONG Lindsay KLEEMAN o.seng.chong@eng.monash.edu.au lindsay.leeman@eng.monash.edu.au Intelligent Robotics Research Centre (IRRC Department

More information

Incorporation of Time Delayed Measurements in a. Discrete-time Kalman Filter. Thomas Dall Larsen, Nils A. Andersen & Ole Ravn

Incorporation of Time Delayed Measurements in a. Discrete-time Kalman Filter. Thomas Dall Larsen, Nils A. Andersen & Ole Ravn Incorporation of Time Delayed Measurements in a Discrete-time Kalman Filter Thomas Dall Larsen, Nils A. Andersen & Ole Ravn Department of Automation, Technical University of Denmark Building 326, DK-2800

More information

Optimization-Based Control

Optimization-Based Control Optimization-Based Control Richard M. Murray Control and Dynamical Systems California Institute of Technology DRAFT v1.7a, 19 February 2008 c California Institute of Technology All rights reserved. This

More information

Autonomous Mobile Robot Design

Autonomous Mobile Robot Design Autonomous Mobile Robot Design Topic: Inertial Measurement Unit Dr. Kostas Alexis (CSE) Where am I? What is my environment? Robots use multiple sensors to understand where they are and how their environment

More information

Introduction to Mobile Robotics Probabilistic Motion Models

Introduction to Mobile Robotics Probabilistic Motion Models Introduction to Mobile Robotics Probabilistic Motion Models Wolfram Burgard 1 Robot Motion Robot motion is inherently uncertain. How can we model this uncertainty? 2 Dynamic Bayesian Network for Controls,

More information

Improving Adaptive Kalman Estimation in GPS/INS Integration

Improving Adaptive Kalman Estimation in GPS/INS Integration THE JOURNAL OF NAVIGATION (27), 6, 517 529. f The Royal Institute of Navigation doi:1.117/s373463374316 Printed in the United Kingdom Improving Adaptive Kalman Estimation in GPS/INS Integration Weidong

More information

A Comparison of the EKF, SPKF, and the Bayes Filter for Landmark-Based Localization

A Comparison of the EKF, SPKF, and the Bayes Filter for Landmark-Based Localization A Comparison of the EKF, SPKF, and the Bayes Filter for Landmark-Based Localization and Timothy D. Barfoot CRV 2 Outline Background Objective Experimental Setup Results Discussion Conclusion 2 Outline

More information

Application of state observers in attitude estimation using low-cost sensors

Application of state observers in attitude estimation using low-cost sensors Application of state observers in attitude estimation using low-cost sensors Martin Řezáč Czech Technical University in Prague, Czech Republic March 26, 212 Introduction motivation for inertial estimation

More information

Analysis of Positioning Uncertainty in Simultaneous Localization and Mapping (SLAM)

Analysis of Positioning Uncertainty in Simultaneous Localization and Mapping (SLAM) Analysis of Positioning Uncertainty in Simultaneous Localization and Mapping (SLAM) Anastasios I. Mourikis and Stergios I. Roumeliotis Dept. of Computer Science & Engineering, University of Minnesota,

More information

Angle estimation using gyros and accelerometers

Angle estimation using gyros and accelerometers Lab in Dynamical systems and control TSRT21 Angle estimation using gyros and accelerometers This version: January 25, 2017 Name: LERTEKNIK REG P-number: Date: AU T O MA R TI C C O N T OL Passed: LINKÖPING

More information

The Scaled Unscented Transformation

The Scaled Unscented Transformation The Scaled Unscented Transformation Simon J. Julier, IDAK Industries, 91 Missouri Blvd., #179 Jefferson City, MO 6519 E-mail:sjulier@idak.com Abstract This paper describes a generalisation of the unscented

More information

Active Nonlinear Observers for Mobile Systems

Active Nonlinear Observers for Mobile Systems Active Nonlinear Observers for Mobile Systems Simon Cedervall and Xiaoming Hu Optimization and Systems Theory Royal Institute of Technology SE 00 44 Stockholm, Sweden Abstract For nonlinear systems in

More information

Automatic Self-Calibration of a Vision System during Robot Motion

Automatic Self-Calibration of a Vision System during Robot Motion Proceedings of the 2006 IEEE International Conference on Robotics and Automation Orlando, Florida - May 2006 Automatic Self-Calibration of a Vision System during Robot Motion Agostino Martinelli, avide

More information

Integration of a strapdown gravimeter system in an Autonomous Underwater Vehicle

Integration of a strapdown gravimeter system in an Autonomous Underwater Vehicle Integration of a strapdown gravimeter system in an Autonomous Underwater Vehicle Clément ROUSSEL PhD - Student (L2G - Le Mans - FRANCE) April 17, 2015 Clément ROUSSEL ISPRS / CIPA Workshop April 17, 2015

More information

MOBILE ROBOT DYNAMICS WITH FRICTION IN SIMULINK

MOBILE ROBOT DYNAMICS WITH FRICTION IN SIMULINK MOBILE ROBOT DYNAMICS WITH FRICTION IN SIMULINK J. Čerkala, A. Jadlovská Department of Cybernetics and Artificial Intelligence, Faculty of Electrical Engineering and Informatics, Technical University of

More information

Vlad Estivill-Castro. Robots for People --- A project for intelligent integrated systems

Vlad Estivill-Castro. Robots for People --- A project for intelligent integrated systems 1 Vlad Estivill-Castro Robots for People --- A project for intelligent integrated systems V. Estivill-Castro 2 Probabilistic Map-based Localization (Kalman Filter) Chapter 5 (textbook) Based on textbook

More information