Introduction to Mobile Robotics

Size: px
Start display at page:

Download "Introduction to Mobile Robotics"

Transcription

1 Introduction to Mobile Robotics Riccardo Falconi Dipartimento di Elettronica, Informatica e Sistemistica (DEIS) Universita di Bologna riccardo.falconi@unibo.it Riccardo Falconi (DEIS) Introduction to Mobile Robotics 1 / 37

2 From Industrial Robotics to Mobile Robotics Starting from the 70s, early industrial robots Used to replace men in case of hazardous/repetivity/easy tasks Typically used for tasks to be executed in loco Workspaces were modeled considering robots capabilities and constraints Riccardo Falconi (DEIS) Introduction to Mobile Robotics 2 / 37

3 From Industrial Robotics to Mobile Robotics Robotics for manipulation Imitates the human arms (and hands) functionalities Mobile Robotics Himitates the animals locomotion principles Definition A mobile robot is an automatic machine able to move into the surrounding environment. Riccardo Falconi (DEIS) Introduction to Mobile Robotics 3 / 37

4 Typical Applications Indoor applications Cleaning Service robotics (museums, shops, etc.) Surveillance Stockings in warehouses... Applicazioni Outdoor Military applications Demining Spatial and underwater exploration Civil protection and fire surveillance Automatic agricultural... Riccardo Falconi (DEIS) Introduction to Mobile Robotics 4 / 37

5 How it all started... Mobile robots starting from 40s Rockets V1 - V2 (inertial autopilots) Drive-by-wire Electric motors Remotely controlled tank 500 m far Riccardo Falconi (DEIS) Introduction to Mobile Robotics 5 / 37

6 Examples AGV automatic warehouse Moves pallets from the loading bay to the depot area and viceversa Inside a warehouse there could be more than 30 AGVs Automatic Guided Vehicle (AGV) Electric 80 Riccardo Falconi (DEIS) Introduction to Mobile Robotics 6 / 37

7 Examples Underwater robots Recover wreckage (Titanic) Pipes inspections Water pollution monitoring Space applications Realized starting from 1965 Highly autonomous Able to work without a supervisor Riccardo Falconi (DEIS) Introduction to Mobile Robotics 7 / 37

8 Examples Agricultural robots ( 2015) Mobile robots designed for agricultural purposes: structured environments (ad hoc orchads) large fields cultivated with cereals Riccardo Falconi (DEIS) Introduction to Mobile Robotics 8 / 37

9 Examples Hazardous robots Robot Pioneer Developed by Stanford University Chosen to explore Chernobyl nuclear plant First modular robot allowing to mount: a robotic arm + a gripper a stereo camera Riccardo Falconi (DEIS) Introduction to Mobile Robotics 9 / 37

10 Locomotion Principles Natural solutions are difficult to be replied from an engineering point of view Walking The rolling is the most efficient solution, but it is not present in nature Most of the robotic systems move using wheels or tracks The walking is the natural best approximation of the rolling Crawling Running Jumping Riccardo Falconi (DEIS) Introduction to Mobile Robotics 10 / 37

11 Locomotion Principles Human walking It approximates rolling of a regular polygon Side of the polygon equal to the step of the person The shortest the step is, the better the rolling is approximated Walking robots: can adapt to a variable environment move slow on flat surfaces overactuated Robot with wheels/tracks: move faster on flat surfaces cannot adapt to a wide range of enviromental conditions Riccardo Falconi (DEIS) Introduction to Mobile Robotics 11 / 37

12 Robot Modeling Riccardo Falconi (DEIS) Introduction to Mobile Robotics 12 / 37

13 Wheeled Mobile Robots - WMR The wheel is the most suitable solution adopted for many applications Three wheels are enough to ensure vehicle stability How many wheels? What kind of wheels? Fixed wheel Centered orientable wheel Castor wheel Swedish wheel Riccardo Falconi (DEIS) Introduction to Mobile Robotics 13 / 37

14 Space of the configurations The dimension of the space of the configurations is equal to the minimum number of parameters needed to localize the robot configuration It depens on the structure of the considered robot Example: Unicycle Y Example: Bicycle Y φ r y r θ r y r θ r x r X x r X q = [x r, y r, θ r ] T R 3 q = [x r, y r, θ r, φ r ] T R 4 Riccardo Falconi (DEIS) Introduction to Mobile Robotics 14 / 37

15 Anolonomous constraints Hipothesys Each wheel rolls without sliding Each wheel introduces a nonholonomic constraint in the system (it does not allow the robot to move perpendicularly to the rolling direction) Wheels reduce the instantaneous robot mobility without reducing the maneuvering capabilities (e.g. parallel parking) ψ y θ v n v t = ψr Without constraint: ( ẋ = v t cos θ + v n cos θ + π ) ( 2 ẏ = v t sin θ + v n sin θ + π ) 2 x As long as the sliding in the normal direction is not allowed v n = 0 { ẋ = vt cosθ tan θ = y [ ẋ sinθ ẏ cosθ = 0 ẏ = v t sinθ x Mobility constraint ] Riccardo Falconi (DEIS) Introduction to Mobile Robotics 15 / 37

16 Pfaffian constraint For each wheel the constraint can be written in a vectorial form as: a(q) q = 0 With N wheels, constraints can be expressed in matrix form as: A(q) q = 0 A constraint that can be written as A(q) q = 0 is called Pfaffian constraint Nonholonomic constraint It is not fully integrable It cannot be written in the space of the configurations It doesn t limit the mobility but only the instantaneous mobility of the robot Allowed velocities They can be generated by using a matrix G(q) such that: Im(G(q)) = Ker(A(q)), q C C = R N Riccardo Falconi (DEIS) Introduction to Mobile Robotics 16 / 37

17 Unicyle model Constraint: ẋ sinθ ẏ cosθ = [sinθ, cosθ, 0] q = 0 Pfaffian { form: A(q) q = 0 A(q) = [sinθ, cosθ, 0] con: q = [x, y, θ] T 02 Ker(A(q)) = 4 cos θ sin θ , 4 Unicycle kinematic model q = cosθ sinθ v ω = 0 1 v: wheel linear velocity ω: angular velocity A = Im(G(q)) cosθ 0 sinθ [ ] v ω Y y r y One orientable wheel x r x θ r X ω ψ v = ψr Riccardo Falconi (DEIS) Introduction to Mobile Robotics 17 / 37

18 Unicycle model The real unicycle has statics stability problems Structures kinematically equivalent are used Synchronized Drive model Parallel orientable and coupled wheels Inputs [v, ω] T [x,y, θ] T position and orientation. y Differential Drive model Two wheels indipendently driven A third wheel to ensure stability [x, y, θ] T position of the centerl of the robot + its orientation. y y r θ r y r θ r x r x x r x Riccardo Falconi (DEIS) Introduction to Mobile Robotics 18 / 37

19 Differential Drive unicycle model y Definite ω R = Right wheel velocity ω L = Left wheel velocity d = wheel axle r = wheel radius ω L θ r Inputs ω R, ω L [ ] [ v r = 2 ω r d r 2 r d ] [ ωr ω L ] y r d 2r ω R x r x State space model ẋ q = ẏ = cosθ 0 sin θ 0 θ 0 1 r [ 2 r d r 2 r d ] [ ] ωr = ω L r cos θ 2 r sin θ d r d r cos θ 2 r sin θ d r d [ ωr ω L ] Riccardo Falconi (DEIS) Introduction to Mobile Robotics 19 / 37

20 Mobile robot control Riccardo Falconi (DEIS) Introduction to Mobile Robotics 20 / 37

21 Control scheme Task Plan High-Level Control Low-Level Control + err. q Control d u τ Act. Sensors (Internal, Envirom.) Robot Model End Effector q F Environment Actuators (DC motors, step-by-step motot,...) End-Effector (gripper, hand, probe, etc.) Sensors Internal state (encoder, gyro,...) Enviromental (bumbers, rangefinders (infrared, ultrasuond), laser, vision (mono, stereo),...) Control Low level High level Riccardo Falconi (DEIS) Introduction to Mobile Robotics 21 / 37

22 Low level control Low-Level Control High level Control Control u Act. τ Robot Model Foundamentals High gain PI controllers are used to control robot motors such that it moves following the desired velocity profile If the gain is high enough, the low level control transforms the robot in a kinematic system Low level control is in charge of controlling the robot actuators following high level controller instructions Riccardo Falconi (DEIS) Introduction to Mobile Robotics 22 / 37

23 Low level vs. High level control Foundamentals The signal provided to the low level controller is computed by analyzing information gathered by sensors Control signals are velocities From a high level point-of-view the robot is considered as a kinematic system Task + err. High level Control q d High-Level Control High level it defines the robot behaviour it takes into account the kinematic model it is subject to wheels constraints it has to control a complex non linear system Low level it controls the motors usually it is a PI control (linear system) it is not affected by wheels constraints Riccardo Falconi (DEIS) Introduction to Mobile Robotics 23 / 37

24 Elementary motion action Point-to-point transfer Initial position Final position Trajectory Following Initial position Parameter s Trajectory Tracking Reference WMR Final position Initial position Reference WMR at time t Parameter t Final position Riccardo Falconi (DEIS) Introduction to Mobile Robotics 24 / 37

25 Motion control Two different problems Configuration Starting from an initial configuration q 0 = [x 0, y 0, θ 0 ] T, the robot has to reach a predefined desired configuration q d = [x d, y d, θ d ] T. More difficult but generic problem Trajectory Starting from an initial configuration q 0 = [x 0, y 0, θ 0 ] T that can be or not on the trajectory, the robot has to reply asymptotically a cartesian trajectory [x d (t), y d (t)] T : Trajectory Following if the problem is position-dependent (s) Trajectory Tracking if the problem is time-depentent (t) Simpler and more practical problem Riccardo Falconi (DEIS) Introduction to Mobile Robotics 25 / 37

26 Trajectory following - I-O SFL Basic idea To define a point b out of the wheels axis To control the point b The point b pulls the vehicle Y y b y r b θ r { xb = x r + b cosθ r y b = y r + b sinθ r, b 0 x r X x b X The point b has no constraints and it can move instantaneously in all the directions The point b can move sideways with respect to the forward direction It is possible to define two inputs to control v x,b and v y,b { ẋb = v x,b ẏ b = v y,b Riccardo Falconi (DEIS) Introduction to Mobile Robotics 26 / 37

27 Trajectory following - I-O SFL ẋ b = ẋ r b ω sin θ r = v cos θ r b ω sin θ r ẏ b = ẏ r + b ω cosθ r = v sin θ r + b ω cosθ r θ r = ω, b 0» ẋb ẏ b» cos θ b sin θr = sin θ b cos θ r» v ω It is possible to prove that if b 0, then det (T(b, θ r )) 0 the matrix T(b, θ r ) is always invertible» v = T(b, θ r) ω Y y b y r b X θ r [ v ω ] [ ] [ = T(b, θ r ) 1 ẋb = ẏ b cosθ sin θ r 1 b sinθ 1 b cosθ r x r x b ] [ ẋb ẏ b ] X Riccardo Falconi (DEIS) Introduction to Mobile Robotics 27 / 37

28 Trajectory following - I-O SFL From the previous relationships the following linear system can be calculated x b = v x,b y b = v The x and y moving directions of the y,b θ r = 1 b (v point b can be controlled indipendently y,b cosθ r v x,b sin θ r ) by using the inputs v x,b and v y,b Given a desired trajectory (x d ( ), y d ( )) to be followed, it is possible to define v x,b and v y,b in order to ensure the asymptotic trajectory tracking by using the following linear control laws: { ẋb = v x,b = ẋ d + K 1 (x d x b ) ẏ b = v y,b = ẏ d + K 2 (y d y b ) Error dynamics { ex = x By defining d x b e y = y d y b { ėx + K 1 e x = 0 ė y + K 2 e y = 0 { ex 0 e y 0 Riccardo Falconi (DEIS) Introduction to Mobile Robotics 28 / 37

29 Trajectory following - I-O SFL Once the inputs to control b have been defined, it is possible to calculate the control inputs to be provided to the unicycle in order to move b as desired [ v ω ] [ = cosθ sinθ r 1 b sinθ 1 b cosθ r ] [ ẋb ẏ b ] Riccardo Falconi (DEIS) Introduction to Mobile Robotics 29 / 37

30 Navigation Interaction with the environment Usually a robot has to move in an environment with static or moving obstacles. By exploiting its knowledge of the environment and by exploiting the data provided by the on-board sensors, the robot has to detect and avoid the obstacles in order to safety navigate the workspace, i.e. avoiding collisions. q goal qstart Navigation problem Given a starting and final configuration, the navigation problem deals with the possibility of finding a collision free path that can be followed by the robot in order to move from the starting to the final configuration. Riccardo Falconi (DEIS) Introduction to Mobile Robotics 30 / 37

31 Navigation: the Braitenberg Algorithm Valentino Braitenberg (Bolzano, 1924). Neuropsychiatric. A simple neural network elaborates the signals provided by the sensors on the right and left side of the robot and it applies the results directly to the motor Braitenberg, V. (1984) I veicoli pensanti. Saggio di psicologia sintetica. Garzanti, Milano Braitenberg, V. (1984) Vehicles: Experiments in synthetic psychology. Cambridge, MA: MIT Press. + + Riccardo Falconi (DEIS) Introduction to Mobile Robotics 31 / 37

32 Navigation: Potential Fields The path planning based on the potential field approach it it possible to plan the path even for fully actuated robots Potential fields allow to generate the the path incrementally by changing it every time an obstacle is detected Potential function Gradient of U U(q) = U : R m R [ U (q)... U ] T (q) q 1 q n q = [q 1, q 2] U(q) = 1 2 qt q U(q) = [q 1, q 2] U(q) is equivalent to an energy function defined over the space configuration U( ) represents the forces generated by the potential field U(q) points in the U growing direction Riccardo Falconi (DEIS) Introduction to Mobile Robotics 32 / 37

33 Navigation: Potential Fields Gradient descent Potential functions are like landscapes where the robot is immersed The robot has to move from a higher point to a lower point The robot has to follow a downhill path (negative gradient) U(q) q(t) = U(q) qstart qstart Local Minimum Global Minimum q q goal The robot moves in a potential field defined as the sum of all the potential field present in the environment Riccardo Falconi (DEIS) Introduction to Mobile Robotics 33 / 37

34 Navigation: Potential Fields To create the potential field to drive a robot from qstart to q goal while avoiding obstacles we have to consider two kind of potential fields Attractive Potential Field U att (q) It has the minimum is in q goal It has to attract the robot toward the goal position Repulsive Potential Field U rep = N obst i=1 U rep i (q) It is calculated as the sum of all the repulsive potential field generated by each obstacle It has to push the robot away from the obstacles Potential field based control law q(t) = U(q), dove: U(q) = U att (q) + U rep (q) Riccardo Falconi (DEIS) Introduction to Mobile Robotics 34 / 37

35 Navigation: Potential Fields Attractive Potential Field Monotonically increasing with (q, q goal ) Robot attracted in (q, q goal ) q goal isolated minimum: no critical points Example U att = 1 2 K a (q, q goal ) U att = 1 2 K a 2 (q, q goal ) = K a (q q goal ) When the robot is far from the goal, it moves slowly When the robot is close to the goal, it moves fast Riccardo Falconi (DEIS) Introduction to Mobile Robotics 35 / 37

36 Navigation: Potential Fields Repulsive Potential Field Given by the sum of the potential field associated to each obstacle The repulsive force increases as long as the robot moves closer to the obstacle The repulsive force is null after a certain predefined distance Example U repi (q) = U repi (q) = If d i(q) = 0, 8 < : 8 < : Kr i d 1 «2 d i(q) q i(q) q 0 d i(q) > q «2 d i(q) d i(q) q d i(q) 0 d i(q) > q K ri 1 q 1 then U rep(q) Local minima Riccardo Falconi (DEIS) Introduction to Mobile Robotics 36 / 37

37 Navigation: Potential Fields and Local Minima The algorithm based on the gradient descent could be stuck in a local minima, that is a particular configuration where attractive and repulsive field are equal q start Possible solutions Best first algorithm Best first randomized algorithm Navigation functions q goal This is not a complete planning method Except some particular cases, the local minima are always present Generically could be avoided by using convex obstacles Adding noise Escape window algorithm Riccardo Falconi (DEIS) Introduction to Mobile Robotics 37 / 37

NONLINEAR PATH CONTROL FOR A DIFFERENTIAL DRIVE MOBILE ROBOT

NONLINEAR PATH CONTROL FOR A DIFFERENTIAL DRIVE MOBILE ROBOT NONLINEAR PATH CONTROL FOR A DIFFERENTIAL DRIVE MOBILE ROBOT Plamen PETROV Lubomir DIMITROV Technical University of Sofia Bulgaria Abstract. A nonlinear feedback path controller for a differential drive

More information

CONTROL OF THE NONHOLONOMIC INTEGRATOR

CONTROL OF THE NONHOLONOMIC INTEGRATOR June 6, 25 CONTROL OF THE NONHOLONOMIC INTEGRATOR R. N. Banavar (Work done with V. Sankaranarayanan) Systems & Control Engg. Indian Institute of Technology, Bombay Mumbai -INDIA. banavar@iitb.ac.in Outline

More information

Robot Control Basics CS 685

Robot Control Basics CS 685 Robot Control Basics CS 685 Control basics Use some concepts from control theory to understand and learn how to control robots Control Theory general field studies control and understanding of behavior

More information

Instrumentation Commande Architecture des Robots Evolués

Instrumentation Commande Architecture des Robots Evolués Instrumentation Commande Architecture des Robots Evolués Program 4a : Automatic Control, Robotics, Signal Processing Presentation General Orientation Research activities concern the modelling and control

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

EN Nonlinear Control and Planning in Robotics Lecture 2: System Models January 28, 2015

EN Nonlinear Control and Planning in Robotics Lecture 2: System Models January 28, 2015 EN53.678 Nonlinear Control and Planning in Robotics Lecture 2: System Models January 28, 25 Prof: Marin Kobilarov. Constraints The configuration space of a mechanical sysetm is denoted by Q and is assumed

More information

Nonholonomic Constraints Examples

Nonholonomic Constraints Examples Nonholonomic Constraints Examples Basilio Bona DAUIN Politecnico di Torino July 2009 B. Bona (DAUIN) Examples July 2009 1 / 34 Example 1 Given q T = [ x y ] T check that the constraint φ(q) = (2x + siny

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

Posture regulation for unicycle-like robots with. prescribed performance guarantees

Posture regulation for unicycle-like robots with. prescribed performance guarantees Posture regulation for unicycle-like robots with prescribed performance guarantees Martina Zambelli, Yiannis Karayiannidis 2 and Dimos V. Dimarogonas ACCESS Linnaeus Center and Centre for Autonomous Systems,

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

Robot Dynamics II: Trajectories & Motion

Robot Dynamics II: Trajectories & Motion Robot Dynamics II: Trajectories & Motion Are We There Yet? METR 4202: Advanced Control & Robotics Dr Surya Singh Lecture # 5 August 23, 2013 metr4202@itee.uq.edu.au http://itee.uq.edu.au/~metr4202/ 2013

More information

Formation Control of Mobile Robots with Obstacle Avoidance using Fuzzy Artificial Potential Field

Formation Control of Mobile Robots with Obstacle Avoidance using Fuzzy Artificial Potential Field Formation Control of Mobile Robots with Obstacle Avoidance using Fuzzy Artificial Potential Field Abbas Chatraei Department of Electrical Engineering, Najafabad Branch, Islamic Azad University, Najafabad,

More information

Robotics, Geometry and Control - A Preview

Robotics, Geometry and Control - A Preview Robotics, Geometry and Control - A Preview Ravi Banavar 1 1 Systems and Control Engineering IIT Bombay HYCON-EECI Graduate School - Spring 2008 Broad areas Types of manipulators - articulated mechanisms,

More information

Non-Collision Conditions in Multi-agent Robots Formation using Local Potential Functions

Non-Collision Conditions in Multi-agent Robots Formation using Local Potential Functions 2008 IEEE International Conference on Robotics and Automation Pasadena, CA, USA, May 19-23, 2008 Non-Collision Conditions in Multi-agent Robots Formation using Local Potential Functions E G Hernández-Martínez

More information

Experimental validation of a decentralized control law for multi-vehicle collective motion

Experimental validation of a decentralized control law for multi-vehicle collective motion Experimental validation of a decentralized control law for multi-vehicle collective motion Daniele Benedettelli, Nicola Ceccarelli, Andrea Garulli, Antonio Giannitrapani Abstract The paper presents the

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

Line following of a mobile robot

Line following of a mobile robot Line following of a mobile robot May 18, 004 1 In brief... The project is about controlling a differential steering mobile robot so that it follows a specified track. Steering is achieved by setting different

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

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

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

ELEC4631 s Lecture 2: Dynamic Control Systems 7 March Overview of dynamic control systems

ELEC4631 s Lecture 2: Dynamic Control Systems 7 March Overview of dynamic control systems ELEC4631 s Lecture 2: Dynamic Control Systems 7 March 2011 Overview of dynamic control systems Goals of Controller design Autonomous dynamic systems Linear Multi-input multi-output (MIMO) systems Bat flight

More information

Autonomous navigation of unicycle robots using MPC

Autonomous navigation of unicycle robots using MPC Autonomous navigation of unicycle robots using MPC M. Farina marcello.farina@polimi.it Dipartimento di Elettronica e Informazione Politecnico di Milano 7 June 26 Outline Model and feedback linearization

More information

Lecture 8: Kinematics: Path and Trajectory Planning

Lecture 8: Kinematics: Path and Trajectory Planning Lecture 8: Kinematics: Path and Trajectory Planning Concept of Configuration Space c Anton Shiriaev. 5EL158: Lecture 8 p. 1/20 Lecture 8: Kinematics: Path and Trajectory Planning Concept of Configuration

More information

We provide two sections from the book (in preparation) Intelligent and Autonomous Road Vehicles, by Ozguner, Acarman and Redmill.

We provide two sections from the book (in preparation) Intelligent and Autonomous Road Vehicles, by Ozguner, Acarman and Redmill. We provide two sections from the book (in preparation) Intelligent and Autonomous Road Vehicles, by Ozguner, Acarman and Redmill. 2.3.2. Steering control using point mass model: Open loop commands We consider

More information

On the stability of nonholonomic multi-vehicle formation

On the stability of nonholonomic multi-vehicle formation Abstract On the stability of nonholonomic multi-vehicle formation Lotfi Beji 1, Mohamed Anouar ElKamel 1, Azgal Abichou 2 1 University of Evry (IBISC EA 4526), 40 rue du Pelvoux, 91020 Evry Cedex, France

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

Extremal Trajectories for Bounded Velocity Mobile Robots

Extremal Trajectories for Bounded Velocity Mobile Robots Extremal Trajectories for Bounded Velocity Mobile Robots Devin J. Balkcom and Matthew T. Mason Abstract Previous work [3, 6, 9, 8, 7, 1] has presented the time optimal trajectories for three classes of

More information

ARTIFICIAL POTENTIAL FIELDS FOR TRAILER-LIKE SYSTEMS 1. T.A. Vidal-Calleja,2 M. Velasco-Villa E. Aranda-Bricaire,3

ARTIFICIAL POTENTIAL FIELDS FOR TRAILER-LIKE SYSTEMS 1. T.A. Vidal-Calleja,2 M. Velasco-Villa E. Aranda-Bricaire,3 ARTIFICIAL POTENTIAL FIELDS FOR TRAILER-LIKE SYSTEMS T.A. Vidal-Calleja, M. Velasco-Villa E. Aranda-Bricaire,3 Departamento de Ingeniería Eléctrica, Sección de Mecatrónica, CINVESTAV-IPĺN, A.P.4 74, 7,

More information

Target Tracking and Obstacle Avoidance for Multi-agent Systems

Target Tracking and Obstacle Avoidance for Multi-agent Systems International Journal of Automation and Computing 7(4), November 2010, 550-556 DOI: 10.1007/s11633-010-0539-z Target Tracking and Obstacle Avoidance for Multi-agent Systems Jing Yan 1 Xin-Ping Guan 1,2

More information

Introduction to Robotics

Introduction to Robotics J. Zhang, L. Einig 277 / 307 MIN Faculty Department of Informatics Lecture 8 Jianwei Zhang, Lasse Einig [zhang, einig]@informatik.uni-hamburg.de University of Hamburg Faculty of Mathematics, Informatics

More information

Extremal Trajectories for Bounded Velocity Differential Drive Robots

Extremal Trajectories for Bounded Velocity Differential Drive Robots Extremal Trajectories for Bounded Velocity Differential Drive Robots Devin J. Balkcom Matthew T. Mason Robotics Institute and Computer Science Department Carnegie Mellon University Pittsburgh PA 523 Abstract

More information

Robotics I. June 6, 2017

Robotics I. June 6, 2017 Robotics I June 6, 217 Exercise 1 Consider the planar PRPR manipulator in Fig. 1. The joint variables defined therein are those used by the manufacturer and do not correspond necessarily to a Denavit-Hartenberg

More information

A motion planner for nonholonomic mobile robots

A motion planner for nonholonomic mobile robots A motion planner for nonholonomic mobile robots Miguel Vargas Material taken form: J. P. Laumond, P. E. Jacobs, M. Taix, R. M. Murray. A motion planner for nonholonomic mobile robots. IEEE Transactions

More information

Today. Why idealized? Idealized physical models of robotic vehicles. Noise. Idealized physical models of robotic vehicles

Today. Why idealized? Idealized physical models of robotic vehicles. Noise. Idealized physical models of robotic vehicles PID controller COMP417 Introduction to Robotics and Intelligent Systems Kinematics and Dynamics Perhaps the most widely used controller in industry and robotics. Perhaps the easiest to code. You will also

More information

Case Study: The Pelican Prototype Robot

Case Study: The Pelican Prototype Robot 5 Case Study: The Pelican Prototype Robot The purpose of this chapter is twofold: first, to present in detail the model of the experimental robot arm of the Robotics lab. from the CICESE Research Center,

More information

Real-time Motion Control of a Nonholonomic Mobile Robot with Unknown Dynamics

Real-time Motion Control of a Nonholonomic Mobile Robot with Unknown Dynamics Real-time Motion Control of a Nonholonomic Mobile Robot with Unknown Dynamics TIEMIN HU and SIMON X. YANG ARIS (Advanced Robotics & Intelligent Systems) Lab School of Engineering, University of Guelph

More information

Ridig Body Motion Homogeneous Transformations

Ridig Body Motion Homogeneous Transformations Ridig Body Motion Homogeneous Transformations Claudio Melchiorri Dipartimento di Elettronica, Informatica e Sistemistica (DEIS) Università di Bologna email: claudio.melchiorri@unibo.it C. Melchiorri (DEIS)

More information

Manipulators. Robotics. Outline. Non-holonomic robots. Sensors. Mobile Robots

Manipulators. Robotics. Outline. Non-holonomic robots. Sensors. Mobile Robots Manipulators P obotics Configuration of robot specified by 6 numbers 6 degrees of freedom (DOF) 6 is the minimum number required to position end-effector arbitrarily. For dynamical systems, add velocity

More information

The bio-inspired chaotic robot

The bio-inspired chaotic robot The bio-inspired chaotic robot Iñaki Rañó Abstract Chaos is an interesting phenomenon displayed by non-linear systems that has been used in robotics and found empirically on real robots behaviour. This

More information

Lecture 14: Kinesthetic haptic devices: Higher degrees of freedom

Lecture 14: Kinesthetic haptic devices: Higher degrees of freedom ME 327: Design and Control of Haptic Systems Autumn 2018 Lecture 14: Kinesthetic haptic devices: Higher degrees of freedom Allison M. Okamura Stanford University (This lecture was not given, but the notes

More information

Robotics I. Test November 29, 2013

Robotics I. Test November 29, 2013 Exercise 1 [6 points] Robotics I Test November 9, 013 A DC motor is used to actuate a single robot link that rotates in the horizontal plane around a joint axis passing through its base. The motor is connected

More information

DIFFERENTIAL KINEMATICS. Geometric Jacobian. Analytical Jacobian. Kinematic singularities. Kinematic redundancy. Inverse differential kinematics

DIFFERENTIAL KINEMATICS. Geometric Jacobian. Analytical Jacobian. Kinematic singularities. Kinematic redundancy. Inverse differential kinematics DIFFERENTIAL KINEMATICS relationship between joint velocities and end-effector velocities Geometric Jacobian Analytical Jacobian Kinematic singularities Kinematic redundancy Inverse differential kinematics

More information

Comparison of two non-linear model-based control strategies for autonomous vehicles

Comparison of two non-linear model-based control strategies for autonomous vehicles Comparison of two non-linear model-based control strategies for autonomous vehicles E. Alcala*, L. Sellart**, V. Puig*, J. Quevedo*, J. Saludes*, D. Vázquez** and A. López** * Supervision & Security of

More information

Robotics I. Figure 1: Initial placement of a rigid thin rod of length L in an absolute reference frame.

Robotics I. Figure 1: Initial placement of a rigid thin rod of length L in an absolute reference frame. Robotics I September, 7 Exercise Consider the rigid body in Fig., a thin rod of length L. The rod will be rotated by an angle α around the z axis, then by an angle β around the resulting x axis, and finally

More information

Unifying Behavior-Based Control Design and Hybrid Stability Theory

Unifying Behavior-Based Control Design and Hybrid Stability Theory 9 American Control Conference Hyatt Regency Riverfront St. Louis MO USA June - 9 ThC.6 Unifying Behavior-Based Control Design and Hybrid Stability Theory Vladimir Djapic 3 Jay Farrell 3 and Wenjie Dong

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

Path Following Mobile Robot in the Presence of Velocity Constraints

Path Following Mobile Robot in the Presence of Velocity Constraints Path Following Mobile Robot in the Presence of Velocity Constraints Martin Bak, Niels Kjølstad Poulsen and Ole Ravn Ørsted DTU, Automation, Building 36, Elektrovej Technical University of Denmark DK-8

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

(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

Research Article Energy Reduction with Anticontrol of Chaos for Nonholonomic Mobile Robot System

Research Article Energy Reduction with Anticontrol of Chaos for Nonholonomic Mobile Robot System Abstract and Applied Analysis Volume 22, Article ID 8544, 4 pages doi:.55/22/8544 Research Article Energy Reduction with Anticontrol of Chaos for Nonholonomic Mobile Robot System Zahra Yaghoubi, Hassan

More information

Balancing of an Inverted Pendulum with a SCARA Robot

Balancing of an Inverted Pendulum with a SCARA Robot Balancing of an Inverted Pendulum with a SCARA Robot Bernhard Sprenger, Ladislav Kucera, and Safer Mourad Swiss Federal Institute of Technology Zurich (ETHZ Institute of Robotics 89 Zurich, Switzerland

More information

Robotics 1 Inverse kinematics

Robotics 1 Inverse kinematics Robotics 1 Inverse kinematics Prof. Alessandro De Luca Robotics 1 1 Inverse kinematics what are we looking for? direct kinematics is always unique; how about inverse kinematics for this 6R robot? Robotics

More information

Robotics 1 Inverse kinematics

Robotics 1 Inverse kinematics Robotics 1 Inverse kinematics Prof. Alessandro De Luca Robotics 1 1 Inverse kinematics what are we looking for? direct kinematics is always unique; how about inverse kinematics for this 6R robot? Robotics

More information

Position and orientation of rigid bodies

Position and orientation of rigid bodies Robotics 1 Position and orientation of rigid bodies Prof. Alessandro De Luca Robotics 1 1 Position and orientation right-handed orthogonal Reference Frames RF A A p AB B RF B rigid body position: A p AB

More information

5. Nonholonomic constraint Mechanics of Manipulation

5. Nonholonomic constraint Mechanics of Manipulation 5. Nonholonomic constraint Mechanics of Manipulation Matt Mason matt.mason@cs.cmu.edu http://www.cs.cmu.edu/~mason Carnegie Mellon Lecture 5. Mechanics of Manipulation p.1 Lecture 5. Nonholonomic constraint.

More information

Visual Feedback Attitude Control of a Bias Momentum Micro Satellite using Two Wheels

Visual Feedback Attitude Control of a Bias Momentum Micro Satellite using Two Wheels Visual Feedback Attitude Control of a Bias Momentum Micro Satellite using Two Wheels Fuyuto Terui a, Nobutada Sako b, Keisuke Yoshihara c, Toru Yamamoto c, Shinichi Nakasuka b a National Aerospace Laboratory

More information

CHAPTER 1. Introduction

CHAPTER 1. Introduction CHAPTER 1 Introduction Linear geometric control theory was initiated in the beginning of the 1970 s, see for example, [1, 7]. A good summary of the subject is the book by Wonham [17]. The term geometric

More information

Mobile Manipulation: Force Control

Mobile Manipulation: Force Control 8803 - Mobile Manipulation: Force Control Mike Stilman Robotics & Intelligent Machines @ GT Georgia Institute of Technology Atlanta, GA 30332-0760 February 19, 2008 1 Force Control Strategies Logic Branching

More information

Model Reference Adaptive Control of Underwater Robotic Vehicle in Plane Motion

Model Reference Adaptive Control of Underwater Robotic Vehicle in Plane Motion Proceedings of the 11th WSEAS International Conference on SSTEMS Agios ikolaos Crete Island Greece July 23-25 27 38 Model Reference Adaptive Control of Underwater Robotic Vehicle in Plane Motion j.garus@amw.gdynia.pl

More information

Cooperative Motion Control of Multiple Autonomous Marine

Cooperative Motion Control of Multiple Autonomous Marine Cooperative Motion Control of Multiple Autonomous Marine Collision Avoidance in Dynamic Environments EECI Graduate School on Control Supélec, Feb. 21-25, 2011 Outline Motivation/Objectives Cooperative

More information

Design and Control of Variable Stiffness Actuation Systems

Design and Control of Variable Stiffness Actuation Systems Design and Control of Variable Stiffness Actuation Systems Gianluca Palli, Claudio Melchiorri, Giovanni Berselli and Gabriele Vassura DEIS - DIEM - Università di Bologna LAR - Laboratory of Automation

More information

Programming Robots in ROS Slides adapted from CMU, Harvard and TU Stuttgart

Programming Robots in ROS Slides adapted from CMU, Harvard and TU Stuttgart Programming Robots in ROS Slides adapted from CMU, Harvard and TU Stuttgart Path Planning Problem Given an initial configuration q_start and a goal configuration q_goal,, we must generate the best continuous

More information

Robotics 1 Inverse kinematics

Robotics 1 Inverse kinematics Robotics 1 Inverse kinematics Prof. Alessandro De Luca Robotics 1 1 Inverse kinematics what are we looking for? direct kinematics is always unique; how about inverse kinematics for this 6R robot? Robotics

More information

Kinematic and Dynamic Models

Kinematic and Dynamic Models Kinematic and Dynamic Models b Advanced Robotics: Navigation and Perception 3/29/2011 1 Reasoning about mobility is important. Image: RedTeamRacing.com 2 ecture Outline Nomenclature Kinematic Constraints

More information

Physics 207 Lecture 10. Lecture 10. Employ Newton s Laws in 2D problems with circular motion

Physics 207 Lecture 10. Lecture 10. Employ Newton s Laws in 2D problems with circular motion Lecture 10 Goals: Employ Newton s Laws in 2D problems with circular motion Assignment: HW5, (Chapters 8 & 9, due 3/4, Wednesday) For Tuesday: Finish reading Chapter 8, start Chapter 9. Physics 207: Lecture

More information

Anytime Planning for Decentralized Multi-Robot Active Information Gathering

Anytime Planning for Decentralized Multi-Robot Active Information Gathering Anytime Planning for Decentralized Multi-Robot Active Information Gathering Brent Schlotfeldt 1 Dinesh Thakur 1 Nikolay Atanasov 2 Vijay Kumar 1 George Pappas 1 1 GRASP Laboratory University of Pennsylvania

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

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

Target Tracking and Obstacle Avoidance for Multi-agent Networks with Input Constraints

Target Tracking and Obstacle Avoidance for Multi-agent Networks with Input Constraints International Journal of Automation and Computing 8(1), February 2011, 46-53 DOI: 10.1007/s11633-010-0553-1 Target Tracking and Obstacle Avoidance for Multi-agent Networks with Input Constraints Jing Yan

More information

Robotics I. Classroom Test November 21, 2014

Robotics I. Classroom Test November 21, 2014 Robotics I Classroom Test November 21, 2014 Exercise 1 [6 points] In the Unimation Puma 560 robot, the DC motor that drives joint 2 is mounted in the body of link 2 upper arm and is connected to the joint

More information

Potential Field Methods

Potential Field Methods Randomized Motion Planning Nancy Amato Fall 04, Univ. of Padova Potential Field Methods [ ] Potential Field Methods Acknowledgement: Parts of these course notes are based on notes from courses given by

More information

Physics 351, Spring 2017, Homework #2. Due at start of class, Friday, January 27, 2017

Physics 351, Spring 2017, Homework #2. Due at start of class, Friday, January 27, 2017 Physics 351, Spring 2017, Homework #2. Due at start of class, Friday, January 27, 2017 Course info is at positron.hep.upenn.edu/p351 When you finish this homework, remember to visit the feedback page at

More information

Tracking and Set-Point VFO Control for an Articulated Mobile Robot with On-Axle Hitched Trailer

Tracking and Set-Point VFO Control for an Articulated Mobile Robot with On-Axle Hitched Trailer 2009 American Control Conference Hyatt Regency Riverfront, St. Louis, MO, USA June 10-12, 2009 WeB07.6 Tracking and Set-Point VFO Control for an Articulated Mobile Robot with On-Axle Hitched Trailer Maciej

More information

Nonlinear Landing Control for Quadrotor UAVs

Nonlinear Landing Control for Quadrotor UAVs Nonlinear Landing Control for Quadrotor UAVs Holger Voos University of Applied Sciences Ravensburg-Weingarten, Mobile Robotics Lab, D-88241 Weingarten Abstract. Quadrotor UAVs are one of the most preferred

More information

VSP 2001/04/20 Prn:27/01/2006; 8:31 {RA} F:ar2385.tex; VTeX/VJ p. 1 (50-131)

VSP 2001/04/20 Prn:27/01/2006; 8:31 {RA} F:ar2385.tex; VTeX/VJ p. 1 (50-131) VSP 2001/04/20 Prn:27/01/2006; 8:31 {RA} F:ar2385.tex; VTeX/VJ p. 1 (50-131) Advanced Robotics, Vol. 00, No. 0, pp. 1 24 (2006) VSP and Robotics Society of Japan 2006. Also available online - www.vsppub.com

More information

Differential Kinematics

Differential Kinematics Differential Kinematics Relations between motion (velocity) in joint space and motion (linear/angular velocity) in task space (e.g., Cartesian space) Instantaneous velocity mappings can be obtained through

More information

Locomotion. Amir Degani. Intro to Robotics CS - Technion Winter Guest Lecture. Locomotion and Manipulation. Locomotion and. Manipulation Duality

Locomotion. Amir Degani. Intro to Robotics CS - Technion Winter Guest Lecture. Locomotion and Manipulation. Locomotion and. Manipulation Duality Locomotion Amir Degani Intro to Robotics CS - Technion Winter 2012 Duality Parts of slides taken from Howie Choset and Matt Mason 1 Today s outline Duality Duality 2 - Duality Locomotion cars, trains,

More information

Lecture Schedule Week Date Lecture (M: 2:05p-3:50, 50-N202)

Lecture Schedule Week Date Lecture (M: 2:05p-3:50, 50-N202) J = x θ τ = J T F 2018 School of Information Technology and Electrical Engineering at the University of Queensland Lecture Schedule Week Date Lecture (M: 2:05p-3:50, 50-N202) 1 23-Jul Introduction + Representing

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

GAIN SCHEDULING CONTROL WITH MULTI-LOOP PID FOR 2- DOF ARM ROBOT TRAJECTORY CONTROL

GAIN SCHEDULING CONTROL WITH MULTI-LOOP PID FOR 2- DOF ARM ROBOT TRAJECTORY CONTROL GAIN SCHEDULING CONTROL WITH MULTI-LOOP PID FOR 2- DOF ARM ROBOT TRAJECTORY CONTROL 1 KHALED M. HELAL, 2 MOSTAFA R.A. ATIA, 3 MOHAMED I. ABU EL-SEBAH 1, 2 Mechanical Engineering Department ARAB ACADEMY

More information

Team-Exercises for DGC 100 Modelica Course

Team-Exercises for DGC 100 Modelica Course Team-Exercises for DGC 100 Modelica Course Hubertus Tummescheit United Technologies Research Center, East Hartford, CT 06108. November 4, 2003 Abstract This document is a preliminary version and is going

More information

Review of Formation Control Approaches and their Implementation Considering a Realistic Model of Mobile Robots

Review of Formation Control Approaches and their Implementation Considering a Realistic Model of Mobile Robots Studienarbeit Review of Formation Control Approaches and their Implementation Considering a Realistic Model of Mobile Robots Hannes Wind Supervisors: Prof. Dr. rer. nat. habil. Thomas Bräunl Prof. Dr.-Ing.

More information

Partially Observable Markov Decision Processes (POMDPs)

Partially Observable Markov Decision Processes (POMDPs) Partially Observable Markov Decision Processes (POMDPs) Sachin Patil Guest Lecture: CS287 Advanced Robotics Slides adapted from Pieter Abbeel, Alex Lee Outline Introduction to POMDPs Locally Optimal Solutions

More information

We are IntechOpen, the world s leading publisher of Open Access books Built by scientists, for scientists. International authors and editors

We are IntechOpen, the world s leading publisher of Open Access books Built by scientists, for scientists. International authors and editors We are IntechOpen, the world s leading publisher of Open Access books Built by scientists, for scientists 4,100 116,000 10M Open access books available International authors and editors Downloads Our authors

More information

The Reflexxes Motion Libraries. An Introduction to Instantaneous Trajectory Generation

The Reflexxes Motion Libraries. An Introduction to Instantaneous Trajectory Generation ICRA Tutorial, May 6, 2013 The Reflexxes Motion Libraries An Introduction to Instantaneous Trajectory Generation Torsten Kroeger 1 Schedule 8:30-10:00 Introduction and basics 10:00-10:30 Coffee break 10:30-11:30

More information

Gain Scheduling Control with Multi-loop PID for 2-DOF Arm Robot Trajectory Control

Gain Scheduling Control with Multi-loop PID for 2-DOF Arm Robot Trajectory Control Gain Scheduling Control with Multi-loop PID for 2-DOF Arm Robot Trajectory Control Khaled M. Helal, 2 Mostafa R.A. Atia, 3 Mohamed I. Abu El-Sebah, 2 Mechanical Engineering Department ARAB ACADEMY FOR

More information

Probability Map Building of Uncertain Dynamic Environments with Indistinguishable Obstacles

Probability Map Building of Uncertain Dynamic Environments with Indistinguishable Obstacles Probability Map Building of Uncertain Dynamic Environments with Indistinguishable Obstacles Myungsoo Jun and Raffaello D Andrea Sibley School of Mechanical and Aerospace Engineering Cornell University

More information

Vision-based Control Laws for Distributed Flocking of Nonholonomic Agents

Vision-based Control Laws for Distributed Flocking of Nonholonomic Agents Vision-based Control Laws for Distributed Flocking of Nonholonomic Agents Nima Moshtagh, Ali Jadbabaie, Kostas Daniilidis GRASP Laboratory, University of Pennsylvania, Philadelphia, PA 94 Email: {nima,

More information

Coordinated Path Following for Mobile Robots

Coordinated Path Following for Mobile Robots Coordinated Path Following for Mobile Robots Kiattisin Kanjanawanishkul, Marius Hofmeister, and Andreas Zell University of Tübingen, Department of Computer Science, Sand 1, 7276 Tübingen Abstract. A control

More information

CONTROL OF ROBOT CAMERA SYSTEM WITH ACTUATOR S DYNAMICS TO TRACK MOVING OBJECT

CONTROL OF ROBOT CAMERA SYSTEM WITH ACTUATOR S DYNAMICS TO TRACK MOVING OBJECT Journal of Computer Science and Cybernetics, V.31, N.3 (2015), 255 265 DOI: 10.15625/1813-9663/31/3/6127 CONTROL OF ROBOT CAMERA SYSTEM WITH ACTUATOR S DYNAMICS TO TRACK MOVING OBJECT NGUYEN TIEN KIEM

More information

Cooperative Collision Avoidance between Multiple Robots based on Bernstein-Bézier Curves

Cooperative Collision Avoidance between Multiple Robots based on Bernstein-Bézier Curves Cooperative Collision Avoidance between Multiple Robots based on Bernstein-Bézier Curves Igor Škrjanc and Gregor Klančar Faculty of Electrical Engineering, University of Ljubljana Tržaška 25, SI-1000 Ljubljana,

More information

Multi-Robotic Systems

Multi-Robotic Systems CHAPTER 9 Multi-Robotic Systems The topic of multi-robotic systems is quite popular now. It is believed that such systems can have the following benefits: Improved performance ( winning by numbers ) Distributed

More information

arxiv: v2 [cs.ro] 9 May 2017

arxiv: v2 [cs.ro] 9 May 2017 Distributed Formation Control of Nonholonomic Mobile Robots by Bounded Feedback in the Presence of Obstacles Thang Nguyen and Hung M. La arxiv:174.4566v2 [cs.ro] 9 May 217 Abstract The problem of distributed

More information

Algorithms for Sensor-Based Robotics: Potential Functions

Algorithms for Sensor-Based Robotics: Potential Functions Algorithms for Sensor-Based Robotics: Potential Functions Computer Science 336 http://www.cs.jhu.edu/~hager/teaching/cs336 Professor Hager http://www.cs.jhu.edu/~hager The Basic Idea A really simple idea:

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

Comparison of two non-linear model-based control strategies for autonomous vehicles

Comparison of two non-linear model-based control strategies for autonomous vehicles Comparison of two non-linear model-based control strategies for autonomous vehicles Eugenio Alcala, Laura Sellart, Vicenc Puig, Joseba Quevedo, Jordi Saludes, David Va zquez and Antonio Lo pez Abstract

More information

WE propose the tracking trajectory control of a tricycle

WE propose the tracking trajectory control of a tricycle Proceedings of the International MultiConference of Engineers and Computer Scientists 7 Vol I, IMECS 7, March - 7, 7, Hong Kong Trajectory Tracking Controller Design for A Tricycle Robot Using Piecewise

More information

Inverse differential kinematics Statics and force transformations

Inverse differential kinematics Statics and force transformations Robotics 1 Inverse differential kinematics Statics and force transformations Prof Alessandro De Luca Robotics 1 1 Inversion of differential kinematics! find the joint velocity vector that realizes a desired

More information

Autonomous Robotic Vehicles

Autonomous Robotic Vehicles Autonomous Robotic Vehicles Ground, Air, Undersea Jim Keller July 15, 2005 Types of Vehicles Ground Wheeled Tracked Legged Crawling/snake Air Fixed wing Powered gliders Rotary wing Flapping wing Morphing

More information

Motion Planning of Discrete time Nonholonomic Systems with Difference Equation Constraints

Motion Planning of Discrete time Nonholonomic Systems with Difference Equation Constraints Vol. 18 No. 6, pp.823 830, 2000 823 Motion Planning of Discrete time Nonholonomic Systems with Difference Equation Constraints Hirohiko Arai The concept of discrete time nonholonomic systems, in which

More information