ME 597: AUTONOMOUS MOBILE ROBOTICS SECTION 3 MOTION MODELING. Prof. Steven Waslander

Size: px
Start display at page:

Download "ME 597: AUTONOMOUS MOBILE ROBOTICS SECTION 3 MOTION MODELING. Prof. Steven Waslander"

Transcription

1 ME 597: AUTONOMOUS MOBILE ROBOTICS SECTION 3 MOTION MODELING Prof. Steven Waslander

2 COMPONENTS Mission Planning Mission Mapping Mission Autonomy Path Planning Mapping Environmental Autonomy Control Estimation Vehicle Autonomy Actuators Vehicle Sensors Hardware 2

3 OUTLINE Example Videos Wheeled, Legged, Aerial, Aquatic Motion Modeling Definitions Kinematics and Dynamics Standard models and disturbances 3

4 SWEDISH WHEELS IN ACTION 4

5 LEGGED ROBOTS IN ACTION 5

6 LEGGED ROBOTS IN ACTION 6

7 AERIAL ROBOTS IN ACTION 7

8 AERIAL ROBOTS IN ACTION 8

9 AERIAL ROBOTS IN ACTION 9

10 AQUATIC ROBOTS IN ACTION 10

11 AQUATIC ROBOTS IN ACTION 11

12 AQUATIC ROBOTS IN ACTION 12

13 OUTLINE Example Videos Wheeled, Legged, Aerial, Aquatic Motion Modeling Definitions Kinematics and Dynamics Standard models and disturbances 13

14 MOTION MODELING A motion model seeks to describe how system motion can occur Given inputs (T), what will the system do (Ɵ)? Define a set of constraints between states and inputs Define unknown disturbances as distributions (ɛ) l T 2 ml mgl sin T mg sin mg 14

15 STATE Recall: The state of a system is a vector of system variables that entirely defines the system at a specific instance in time. The state may include variables describing only the vehicle, or the vehicle and it s environment Common Vehicle States: Position, Velocity, Attitude, Attitude Rates, Motor Speeds, Battery/Fuel Level Common Environment States: Feature Locations, Surface Polygons and Normals, Wind Conditions, Ocean Currents 15

16 COMPLETE STATE Definition: A state vector is complete if it is the best predictor of the future. Known as the Markov Assumption Ensures that past and future states are independent if the current state is known Very useful for estimation and control No need to store excessive amounts of data, only the current state Must balance size of model (number of states) with violations of Markov assumption Ignoring the state of wind on an aircraft leads to significant errors in velocity control However, integral control can accommodate 16

17 INPUTS Definition: The inputs of a system are the set of variables that drive the system that can be controlled. The same notion as in classical and state space controls Common vehicle inputs: Motor throttle, voltage, servo pwm command, steering angle, elevator angle Referred to as control actions in Thrun et al. 17

18 DISTURBANCES Definition: The disturbances of a system are the set of variables that drive the system that cannot be controlled. Disturbances are why we need a control system (and stability), cause uncertainty in state The better the model of disturbances, the better their effect can be rejected. Most common model used is additive Gaussian Often then augmented with linear, nonlinear mapping 18

19 MOTION MODEL The discrete time motion model is defined as x f ( x, u, ) t t1 t t x t is the state vector at time t u t is the input vector at time t Ɛ t is the disturbance to the system at time t e.g. ~ N(0, R ) f(x t-1,u t, Ɛ t ) is the motion model t Can be linear, nonlinear, discontinuous, hybrid t 19

20 MOTION MODEL The Markov assumption implies the following dependencies The motion model captures a single transition from one time period to the next Motion Model x 0 x 1 x t-1 x t u 1 u t-1 u t 20

21 MOTION MODEL TYPES Linear models with additive Gaussian disturbances Linear models satisfy superposition Can always be written in standard form x Ax Bu t t1 t t Nonlinear models with additive Gaussian disturbances x f ( x, u ) t t1 t t Nonlinear models with nonlinear disturbances x f ( x, u, ) t t1 t t 21

22 MOTION MODEL TYPES Motion models can be viewed in other ways Probabilistically, the probability of ending in state x t given input u t and prior state x t-1 px ( x, u) t t1 t Continuous time, the rate of change of the states is governed by a nonlinear function of state, input and disturbances x f ( xu,, ) 22

23 MOTION MODELS Degrees of freedom vs. states Degrees of freedom are axes of independent motion, whereas states may also include derivatives and other terms. A quadrotor has 6 degrees of freedom (X, Y, Z, roll, pitch, yaw) but at least 12 states. Constraints on the motion Holonomic vs. nonholonomic constraints Holonomic constraints depend only on the position of the vehicle On the states that define the degrees of freedom Nonholonomic constraints also depend on velocity (or the derivatives of the position) On all states, on how a vehicle moves 23

24 KINEMATIC AND DYNAMIC MODELS At low speeds, it is often sufficient to look only at kinematic models of vehicles Two wheeled robot Bicycle model However, when forces vary with the state, more precise modeling can be beneficial Dynamic modeling of cars for cruise control Quadrotor dynamics In this course, models will mostly be supplied, assume you already know how to define them These notes now cover the basic models we use 24

25 MOTION MODELS Five basic models to be used throughout course Linear dynamic model AUV Simple 2D Nonholonomic model Two-wheel robot, speed and rotation rate inputs 2D Nonholonomic model Two-wheel robot, left and right wheel speed inputs Bicycle model Two wheel model with speed and steering angle Valid for four wheel cars as well Quadrotor dynamic model Example of 6DOF model with four thrust inputs 25

26 LINEAR DYNAMIC MODEL Linear Example Simple AUV 3D Linear motion model for three thruster AUV (attitude held constant) State pn v n pe x v e pd v d Input Continuous dynamics for x () t v () t n n T u T T n e d mv () t bv () t T () t n n n 26

27 LINEAR DYNAMIC MODEL Example Linear AUV Should always perform discretization through zeroorder hold, first-order hold, Tustins Simple alternative (for exams, proof of concept): Approximating left hand side derivatives with finite differences, holding right hand side at previous values x nt, nt, 1 Solving for current state v x dt v v nt, 1 nt, nt, 1 m bvnt, 1 Tnt, dt x x v dt nt, nt, 1 nt, 1 nt, vnt, vnt, 1 vnt, 1dt dt b T m m 27

28 LINEAR DYNAMIC MODEL Example Linear AUV Discrete Dynamics 1 dt bdt n / m dt / m dt x x u bdt m dt bdt d / m 0 0 dt / m t t1 t e / dt / m 0 Comes from approximation to matrix exponential At e I Adt More accurate approaches (which rely on actually calculating matrix exponential) can be used by taking advantage of built-in Matlab tools. 28

29 LINEAR DYNAMIC MODEL Example Linear AUV Discrete Dynamics from zero order hold of continuous model (only N,E directions for plotting purposes) xt xt 1 ut t Comparison to above solution xt xt 1 ut t

30 LINEAR DYNAMIC MODEL Example Linear AUV in X,Y plane t 10 dt 0.1 sin( t) u cos( t) 30

31 TWO-WHEELED KINEMATIC MODEL Two-wheeled robot Vehicle State, Inputs: Y I x1 x x y 2 x 3 u1 v u 2 y Motion Model O x X I x1, t x1, t1 u1, tcos x3, t1dt x gx (, u) x u sinx dt 2, t t1 t 2, t1 1, t 3, t1 x3, t x3, t1 u2, tdt 31

32 TWO-WHEELED KINEMATIC MODEL Two-wheeled robot with additive Gaussian disturbances Disturbance model ~ N(0, R ) t R t diagonal Independent disturbances t Y I y Motion Model O x x1, t x1, t1 u1, tcos x3, t1dt x 2, t g( xt 1, ut, t) x2, t1 u1, tsinx3, t1dt t x x u dt 3, t 3, t1 2, t X I 32

33 TWO-WHEELED KINEMATIC MODEL Example: Two-wheeled robot with additive Gaussian disturbances R

34 KINEMATIC MODEL Two-wheeled robot with nonlinear disturbances Speed, heading affected Y I v t t v ~ N(0, R ) ~ N(0, R ) t t y Motion Model O x v cos x 1, t 1 1, t t 3, t 1 t 1, t x u x dt v x 2, t gx ( t1, ut, t) x2, t1 u1, t t sin x3, t1 t dt x 3, t x3, t1 t u2, tdt X I 34

35 KINEMATIC MODEL Example: Two-wheeled robot with nonlinear disturbances (accurate steering and velocity control) R

36 TWO-WHEELED KINEMATIC MODEL Example: Two-wheeled robot with nonlinear disturbances (poor steering) R

37 TWO-WHEELED KINEMATIC MODEL Example: Two-wheeled robot with nonlinear disturbances (poor velocity control) R

38 TWO-WHEELED KINEMATIC MODEL If the control inputs are wheel speeds, can augment the model as follows: Center: p Wheel to center: l Wheel radius: r Wheel rotation rates: w1, w2 w 2, v p r w l

39 TWO-WHEELED KINEMATIC MODEL Kinematic constraint v i rw i w i r v i v i 39

40 TWO-WHEELED KINEMATIC MODEL Velocity is the average of the two wheel velocities We can use the instantaneous centre of rotation (ICR) v 2 v v rw rw 2 2 v v v 1 40 ICR

41 TWO-WHEELED KINEMATIC MODEL Equivalent triangles give the angular rate equation v 2 2l v2 ( v2 v1) 2l v 1 rw rw 2l 1 2 ICR 41

42 TWO-WHEELED KINEMATIC MODEL So we now have a pair of equality constraints that relate the wheel rotation rates to the speed and rotation rate of the vehicle. Return to the standard 2 wheel robot, but change the inputs Vehicle State: Y I x1 x x y 2 x 3 y Inputs: ut,1 w1 u t,2 w 2 O x X I 42

43 TWO-WHEELED KINEMATIC MODEL Summarizing the kinematic model in body coordinates rw rw 1 2 v 2 rw rw 2l 1 2 () t Finally, the full dynamics of the vehicle are rw1 rw2cos cos 2 x v rw rw y vsin sin 2 rw1 rw 2 2l 1 2 vt () () t 43

44 BICYCLE KINEMATIC MODEL Bicycle model Front wheel steering Track motion of rear wheel Rear x, y dynamics same as before Front wheel Y x x v cos dt t t1 t t1 y t yt 1 vtsint 1dt xy, f x f, t x f, t1vt cos t 1t dt f y f, t yf, t1vt sin t 1t dt x xlcos, y ylsin f v f x f, y f L v f X 44

45 BICYCLE KINEMATIC MODEL For rotation, we rely on the Instantaneous Center of Rotation (ICR) again 1. v R ICR tan L R v vtan R L R v L v f 4. t t 1 v t tant dt L 45

46 BICYCLE KINEMATIC MODEL Standard bicycle model xt xt 1 vtcost 1dt y t yt 1 vtsint 1dt t vt tant t1 dt L Y xy, v x f, y f L Good model for cars, Ackermann robots Add drivetrain dynamics which affect speed control X 46

47 DYNAMIC MODELS For some robots, kinematics are insufficient to describe relationship between inputs and vehicle state Dynamics include forces and moments acting on robot in motion model Process: Draw Free Body Diagram Define equations of motion Model forces and moments acting on vehicle 47

48 DYNAMIC MODELS Example: Quadrotor helicopter Free Body Diagram T 1 Q 1 D 1 mg D b 48

49 DYNAMIC MODELS -STANDARD FORMS (EULER) Inertial frame Mixed frame Body frame p I v mv F I I R J I E R B I I B B M I I I p I v mv F I I R I E B J J M B B B B p v I v I R v I I B B mv mv F R B B B B E B J J M B B B B Common matrix form mi 0v b b mvb FB 0 J b b J b M B 49

50 DYNAMIC MODELS Equations of motion Standard 6 DOF motion model p I mv I v R I E F I B J M J B B B B I p I v I Can be used for any rigid body that translates and rotates in 3D Naturally aligns with inertial (GPS) position and body (gyro) angular rate measurement 50

51 DYNAMICS Forces acting on vehicle 4 I F ˆ ˆ ˆ ˆ I RB( Tiz Dieh) DBe mgd i1 Moments acting on vehicle 4 i ˆ ˆ ˆ B iz i ri z i ri eh i1 M ( 1) Q T( ) D( ) T 1 Q 1 D 1 mg D b 51

52 RESULTING MOTION Trajectory Control in Windy Conditions 52 Carlos Wang, University of Waterloo, 2009

53 EXTRA SLIDES 53

54 WHEEL CONFIGURATIONS Two-wheeled Bicycle Segway Three-wheeled Dolley Tricycle Big Wheel Omni-directional Four-wheeled Rear/Front/4 WD Crazy vehicles 54

55 WHEELED MOTION Kinematics governed by wheel number, type, geometry Standard 2DOF Caster 3DOF Chair Swedish 3DOF Robocup Spherical 3DOF, Impractical 55

56 WHEEL CHOICE Main Issues: Stability Maneuverability Controllability Mechanical Complexity Image courtesy of Payam Sabzmeydani Image courtesy of Segway Image courtesy of Segway Passive stability is guaranteed with 3 wheels, improved with 4 wheels Active stability required with less (bicycle, Segway) Maneuverability/Controllability/Complexity Combining steering and drive on one wheel difficult to realize but great for control (front wheel drive) 56

57 UNEVEN TERRAIN Suspension required to maintain contact, smooth sensor motion Bigger wheels effective for overcoming obstacles, but require more torque 57 Image courtesy of T. Barfoot Image courtesy of EPFL

58 LEGGED MOTION Inspired by nature, less efficient, more maneuverable than wheeled motion Number of legs determines stability Number of joints determines maneuverability 58 Image courtesy of Lego

59 LEGGED MOTION Usually requires predefined gait Sequence of motions that achieves forward mobility Dynamics quite complex, specialized Free Fly 59 Changeover Walking Galloping

60 LEGGED MOTION Once gait is defined, motion can be approximated by rolling polygon Leg angle Polygon sides Hip height Forward speed 1 d /2 sin l n h lcos h mdt d m steps per second, δt elapsed time 60 l h

61 LEGGED MOTION Red circle = hip height Leg length = step distance = 1 Steps per second =

62 AERIAL MOTION Fixed Wing Longitudinal Forces and Moments Elevator causes moment about cg Tail resists rotation about cg (damping) Total lift and weight approximately balance Drag increases with elevator deflection Wing Lift Drag Tail Lift Weight Elevator Force 62

63 AERIAL MOTION Rotary wing: Quadrotors have two pairs of counter-rotating blades allow for fixed pitch rotors and independent actuation of roll, pitch, yaw and altitude Yaw Torque Roll/Pitch Torque Total Thrust for Motion 63 63

64 AERIAL MOTION Flapping Wing Biologically inspired, difficult to achieve comparable efficiency to fixed, rotary wing Similar approach to walking Produce cyclic model of forces and moments Dr. James DeLaurier, 2006 University of Toronto Aerospace Institute 64

65 UWMAV IN ACTION 65

66 AQUATIC MOTION Ship motion, close to planar ground robot Propulsion and steering at rear Sideslip possible Augmented model may include roll, pitch Submersible motion, analogous to fixed wing aircraft Buoancy replaces lift to counteract gravity Swimming motion Complex cyclic behaviour, can be modeled in a similar manner to walking, flapping 66

67 AQUATIC ROBOTS IN ACTION World Autonomous Sailing Competition

68 SWEDISH WHEEL ROBOT x v 1 1, y 120 v 3 l 2 3 p r v 2 68

ME 597: AUTONOMOUS MOBILE ROBOTICS SECTION 4 CONTROL. Prof. Steven Waslander

ME 597: AUTONOMOUS MOBILE ROBOTICS SECTION 4 CONTROL. Prof. Steven Waslander ME 597: AUTONOMOUS MOBILE ROBOTICS SECTION 4 CONTROL Prof. Steven Waslander COMPONENTS Mission Planning Mission Mapping Mission Autonomy Path Planning Mapping Environmental Autonomy Control Estimation

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

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

Quadcopter Dynamics 1

Quadcopter Dynamics 1 Quadcopter Dynamics 1 Bréguet Richet Gyroplane No. 1 1907 Brothers Louis Bréguet and Jacques Bréguet Guidance of Professor Charles Richet The first flight demonstration of Gyroplane No. 1 with no control

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

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

Quadrotor Modeling and Control

Quadrotor Modeling and Control 16-311 Introduction to Robotics Guest Lecture on Aerial Robotics Quadrotor Modeling and Control Nathan Michael February 05, 2014 Lecture Outline Modeling: Dynamic model from first principles Propeller

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

Chapter 4 The Equations of Motion

Chapter 4 The Equations of Motion Chapter 4 The Equations of Motion Flight Mechanics and Control AEM 4303 Bérénice Mettler University of Minnesota Feb. 20-27, 2013 (v. 2/26/13) Bérénice Mettler (University of Minnesota) Chapter 4 The Equations

More information

Chapter 1 Lecture 2. Introduction 2. Topics. Chapter-1

Chapter 1 Lecture 2. Introduction 2. Topics. Chapter-1 Chapter 1 Lecture 2 Introduction 2 Topics 1.4 Equilibrium of airplane 1.5 Number of equations of motion for airplane in flight 1.5.1 Degrees of freedom 1.5.2 Degrees of freedom for a rigid airplane 1.6

More information

Mathematical Modelling and Dynamics Analysis of Flat Multirotor Configurations

Mathematical Modelling and Dynamics Analysis of Flat Multirotor Configurations Mathematical Modelling and Dynamics Analysis of Flat Multirotor Configurations DENIS KOTARSKI, Department of Mechanical Engineering, Karlovac University of Applied Sciences, J.J. Strossmayera 9, Karlovac,

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

Chapter 1. Introduction. 1.1 System Architecture

Chapter 1. Introduction. 1.1 System Architecture Chapter 1 Introduction 1.1 System Architecture The objective of this book is to prepare the reader to do research in the exciting and rapidly developing field of autonomous navigation, guidance, and control

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

Exam - TTK 4190 Guidance & Control Eksamen - TTK 4190 Fartøysstyring

Exam - TTK 4190 Guidance & Control Eksamen - TTK 4190 Fartøysstyring Page 1 of 6 Norges teknisk- naturvitenskapelige universitet Institutt for teknisk kybernetikk Faglig kontakt / contact person: Navn: Morten Pedersen, Universitetslektor Tlf.: 41602135 Exam - TTK 4190 Guidance

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

Robot Dynamics - Rotary Wing UAS: Control of a Quadrotor

Robot Dynamics - Rotary Wing UAS: Control of a Quadrotor Robot Dynamics Rotary Wing AS: Control of a Quadrotor 5-85- V Marco Hutter, Roland Siegwart and Thomas Stastny Robot Dynamics - Rotary Wing AS: Control of a Quadrotor 7..6 Contents Rotary Wing AS. Introduction

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

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

Hover Control for Helicopter Using Neural Network-Based Model Reference Adaptive Controller

Hover Control for Helicopter Using Neural Network-Based Model Reference Adaptive Controller Vol.13 No.1, 217 مجلد 13 العدد 217 1 Hover Control for Helicopter Using Neural Network-Based Model Reference Adaptive Controller Abdul-Basset A. Al-Hussein Electrical Engineering Department Basrah University

More information

Fundamentals of Airplane Flight Mechanics

Fundamentals of Airplane Flight Mechanics David G. Hull Fundamentals of Airplane Flight Mechanics With 125 Figures and 25 Tables y Springer Introduction to Airplane Flight Mechanics 1 1.1 Airframe Anatomy 2 1.2 Engine Anatomy 5 1.3 Equations of

More information

Design and modelling of an airship station holding controller for low cost satellite operations

Design and modelling of an airship station holding controller for low cost satellite operations AIAA Guidance, Navigation, and Control Conference and Exhibit 15-18 August 25, San Francisco, California AIAA 25-62 Design and modelling of an airship station holding controller for low cost satellite

More information

Video 1.1 Vijay Kumar and Ani Hsieh

Video 1.1 Vijay Kumar and Ani Hsieh Video 1.1 Vijay Kumar and Ani Hsieh 1 Robotics: Dynamics and Control Vijay Kumar and Ani Hsieh University of Pennsylvania 2 Why? Robots live in a physical world The physical world is governed by the laws

More information

QUADROTOR: FULL DYNAMIC MODELING, NONLINEAR SIMULATION AND CONTROL OF ATTITUDES

QUADROTOR: FULL DYNAMIC MODELING, NONLINEAR SIMULATION AND CONTROL OF ATTITUDES QUADROTOR: FULL DYNAMIC MODELING, NONLINEAR SIMULATION AND CONTROL OF ATTITUDES Somayeh Norouzi Ghazbi,a, Ali Akbar Akbari 2,a, Mohammad Reza Gharib 3,a Somaye_noroozi@yahoo.com, 2 Akbari@um.ac.ir, 3 mech_gharib@yahoo.com

More information

Applications Linear Control Design Techniques in Aircraft Control I

Applications Linear Control Design Techniques in Aircraft Control I Lecture 29 Applications Linear Control Design Techniques in Aircraft Control I Dr. Radhakant Padhi Asst. Professor Dept. of Aerospace Engineering Indian Institute of Science - Bangalore Topics Brief Review

More information

Chapter 9. Nonlinear Design Models. Beard & McLain, Small Unmanned Aircraft, Princeton University Press, 2012, Chapter 9, Slide 1

Chapter 9. Nonlinear Design Models. Beard & McLain, Small Unmanned Aircraft, Princeton University Press, 2012, Chapter 9, Slide 1 Chapter 9 Nonlinear Design Models Beard & McLain, Small Unmanned Aircraft, Princeton University Press, 2012, Chapter 9, Slide 1 Architecture Destination, obstacles Waypoints Path Definition Airspeed, Altitude,

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

Lecture AC-1. Aircraft Dynamics. Copy right 2003 by Jon at h an H ow

Lecture AC-1. Aircraft Dynamics. Copy right 2003 by Jon at h an H ow Lecture AC-1 Aircraft Dynamics Copy right 23 by Jon at h an H ow 1 Spring 23 16.61 AC 1 2 Aircraft Dynamics First note that it is possible to develop a very good approximation of a key motion of an aircraft

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

Autonomous Mobile Robot Design

Autonomous Mobile Robot Design Autonomous Mobile Robot Design Topic: Micro Aerial Vehicle Dynamics Dr. Kostas Alexis (CSE) Goal of this lecture The goal of this lecture is to derive the equations of motion that describe the motion of

More information

What is flight dynamics? AE540: Flight Dynamics and Control I. What is flight control? Is the study of aircraft motion and its characteristics.

What is flight dynamics? AE540: Flight Dynamics and Control I. What is flight control? Is the study of aircraft motion and its characteristics. KING FAHD UNIVERSITY Department of Aerospace Engineering AE540: Flight Dynamics and Control I Instructor Dr. Ayman Hamdy Kassem What is flight dynamics? Is the study of aircraft motion and its characteristics.

More information

Rotor reference axis

Rotor reference axis Rotor reference axis So far we have used the same reference axis: Z aligned with the rotor shaft Y perpendicular to Z and along the blade (in the rotor plane). X in the rotor plane and perpendicular do

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

The basic principle to be used in mechanical systems to derive a mathematical model is Newton s law,

The basic principle to be used in mechanical systems to derive a mathematical model is Newton s law, Chapter. DYNAMIC MODELING Understanding the nature of the process to be controlled is a central issue for a control engineer. Thus the engineer must construct a model of the process with whatever information

More information

Autopilot design for small fixed wing aerial vehicles. Randy Beard Brigham Young University

Autopilot design for small fixed wing aerial vehicles. Randy Beard Brigham Young University Autopilot design for small fixed wing aerial vehicles Randy Beard Brigham Young University Outline Control architecture Low level autopilot loops Path following Dubins airplane paths and path management

More information

Introduction to Flight Dynamics

Introduction to Flight Dynamics Chapter 1 Introduction to Flight Dynamics Flight dynamics deals principally with the response of aerospace vehicles to perturbations in their flight environments and to control inputs. In order to understand

More information

Dynamic Modeling and Stabilization Techniques for Tri-Rotor Unmanned Aerial Vehicles

Dynamic Modeling and Stabilization Techniques for Tri-Rotor Unmanned Aerial Vehicles Technical Paper Int l J. of Aeronautical & Space Sci. 11(3), 167 174 (010) DOI:10.5139/IJASS.010.11.3.167 Dynamic Modeling and Stabilization Techniques for Tri-Rotor Unmanned Aerial Vehicles Dong-Wan Yoo*,

More information

A Comparison of Closed-Loop Performance of Multirotor Configurations Using Non-Linear Dynamic Inversion Control

A Comparison of Closed-Loop Performance of Multirotor Configurations Using Non-Linear Dynamic Inversion Control Aerospace 2015, 2, 325-352; doi:10.3390/aerospace2020325 OPEN ACCESS aerospace ISSN 2226-4310 www.mdpi.com/journal/aerospace Article A Comparison of Closed-Loop Performance of Multirotor Configurations

More information

AS3010: Introduction to Space Technology

AS3010: Introduction to Space Technology AS3010: Introduction to Space Technology L E C T U R E 22 Part B, Lecture 22 19 April, 2017 C O N T E N T S Attitude stabilization passive and active. Actuators for three axis or active stabilization.

More information

A Model-Free Control System Based on the Sliding Mode Control Method with Applications to Multi-Input-Multi-Output Systems

A Model-Free Control System Based on the Sliding Mode Control Method with Applications to Multi-Input-Multi-Output Systems Proceedings of the 4 th International Conference of Control, Dynamic Systems, and Robotics (CDSR'17) Toronto, Canada August 21 23, 2017 Paper No. 119 DOI: 10.11159/cdsr17.119 A Model-Free Control System

More information

Chapter 3 Numerical Methods

Chapter 3 Numerical Methods Chapter 3 Numerical Methods Part 3 3.4 Differential Algebraic Systems 3.5 Integration of Differential Equations 1 Outline 3.4 Differential Algebraic Systems 3.4.1 Constrained Dynamics 3.4.2 First and Second

More information

Robotics. Dynamics. Marc Toussaint U Stuttgart

Robotics. Dynamics. Marc Toussaint U Stuttgart Robotics Dynamics 1D point mass, damping & oscillation, PID, dynamics of mechanical systems, Euler-Lagrange equation, Newton-Euler recursion, general robot dynamics, joint space control, reference trajectory

More information

TTK4190 Guidance and Control Exam Suggested Solution Spring 2011

TTK4190 Guidance and Control Exam Suggested Solution Spring 2011 TTK4190 Guidance and Control Exam Suggested Solution Spring 011 Problem 1 A) The weight and buoyancy of the vehicle can be found as follows: W = mg = 15 9.81 = 16.3 N (1) B = 106 4 ( ) 0.6 3 3 π 9.81 =

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

A Blade Element Approach to Modeling Aerodynamic Flight of an Insect-scale Robot

A Blade Element Approach to Modeling Aerodynamic Flight of an Insect-scale Robot A Blade Element Approach to Modeling Aerodynamic Flight of an Insect-scale Robot Taylor S. Clawson, Sawyer B. Fuller Robert J. Wood, Silvia Ferrari American Control Conference Seattle, WA May 25, 2016

More information

Translational and Rotational Dynamics!

Translational and Rotational Dynamics! Translational and Rotational Dynamics Robert Stengel Robotics and Intelligent Systems MAE 345, Princeton University, 217 Copyright 217 by Robert Stengel. All rights reserved. For educational use only.

More information

Quaternion-Based Tracking Control Law Design For Tracking Mode

Quaternion-Based Tracking Control Law Design For Tracking Mode A. M. Elbeltagy Egyptian Armed forces Conference on small satellites. 2016 Logan, Utah, USA Paper objectives Introduction Presentation Agenda Spacecraft combined nonlinear model Proposed RW nonlinear attitude

More information

Week 3: Wheeled Kinematics AMR - Autonomous Mobile Robots

Week 3: Wheeled Kinematics AMR - Autonomous Mobile Robots Week 3: Wheeled Kinematics AMR - Paul Furgale Margarita Chli, Marco Hutter, Martin Rufli, Davide Scaramuzza, Roland Siegwart Wheeled Kinematics 1 AMRx Flipped Classroom A Matlab exercise is coming later

More information

Robotics. Dynamics. University of Stuttgart Winter 2018/19

Robotics. Dynamics. University of Stuttgart Winter 2018/19 Robotics Dynamics 1D point mass, damping & oscillation, PID, dynamics of mechanical systems, Euler-Lagrange equation, Newton-Euler, joint space control, reference trajectory following, optimal operational

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

Quadrotor Modeling and Control for DLO Transportation

Quadrotor Modeling and Control for DLO Transportation Quadrotor Modeling and Control for DLO Transportation Thesis dissertation Advisor: Prof. Manuel Graña Computational Intelligence Group University of the Basque Country (UPV/EHU) Donostia Jun 24, 2016 Abstract

More information

Simple Car Dynamics. Outline. Claude Lacoursière HPC2N/VRlab, Umeå Universitet, Sweden, May 18, 2005

Simple Car Dynamics. Outline. Claude Lacoursière HPC2N/VRlab, Umeå Universitet, Sweden, May 18, 2005 Simple Car Dynamics Claude Lacoursière HPC2N/VRlab, Umeå Universitet, Sweden, and CMLabs Simulations, Montréal, Canada May 18, 2005 Typeset by FoilTEX May 16th 2005 Outline basics of vehicle dynamics different

More information

MECH 3140 Final Project

MECH 3140 Final Project MECH 3140 Final Project Final presentation will be held December 7-8. The presentation will be the only deliverable for the final project and should be approximately 20-25 minutes with an additional 10

More information

Modelling of Opposed Lateral and Longitudinal Tilting Dual-Fan Unmanned Aerial Vehicle

Modelling of Opposed Lateral and Longitudinal Tilting Dual-Fan Unmanned Aerial Vehicle Modelling of Opposed Lateral and Longitudinal Tilting Dual-Fan Unmanned Aerial Vehicle N. Amiri A. Ramirez-Serrano R. Davies Electrical Engineering Department, University of Calgary, Canada (e-mail: namiri@ucalgary.ca).

More information

Trajectory tracking & Path-following control

Trajectory tracking & Path-following control Cooperative Control of Multiple Robotic Vehicles: Theory and Practice Trajectory tracking & Path-following control EECI Graduate School on Control Supélec, Feb. 21-25, 2011 A word about T Tracking and

More information

Basic ground vehicle dynamics 1. Prof. R.G. Longoria Spring 2015

Basic ground vehicle dynamics 1. Prof. R.G. Longoria Spring 2015 Basic ground vehicle dynamics 1 Prof. R.G. Longoria Spring 2015 Overview We will be studying wheeled vehicle systems in this course and in the lab, so we ll let that work drive our discussion. Before thinking

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

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

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. CSC752: Autonomous Robotic Systems. Ubbo Visser. March 9, Department of Computer Science University of Miami

Control. CSC752: Autonomous Robotic Systems. Ubbo Visser. March 9, Department of Computer Science University of Miami Control CSC752: Autonomous Robotic Systems Ubbo Visser Department of Computer Science University of Miami March 9, 2017 Outline 1 Control system 2 Controller Images from http://en.wikipedia.org/wiki/feed-forward

More information

Different Approaches of PID Control UAV Type Quadrotor

Different Approaches of PID Control UAV Type Quadrotor Different Approaches of PD Control UAV ype Quadrotor G. Szafranski, R. Czyba Silesian University of echnology, Akademicka St 6, Gliwice, Poland ABSRAC n this paper we focus on the different control strategies

More information

Visual Servoing for a Quadrotor UAV in Target Tracking Applications. Marinela Georgieva Popova

Visual Servoing for a Quadrotor UAV in Target Tracking Applications. Marinela Georgieva Popova Visual Servoing for a Quadrotor UAV in Target Tracking Applications by Marinela Georgieva Popova A thesis submitted in conformity with the requirements for the degree of Master of Applied Science Graduate

More information

Time Response of Dynamic Systems! Multi-Dimensional Trajectories Position, velocity, and acceleration are vectors

Time Response of Dynamic Systems! Multi-Dimensional Trajectories Position, velocity, and acceleration are vectors Time Response of Dynamic Systems Robert Stengel Robotics and Intelligent Systems MAE 345, Princeton University, 217 Multi-dimensional trajectories Numerical integration Linear and nonlinear systems Linearization

More information

MEAM 510 Fall 2012 Bruce D. Kothmann

MEAM 510 Fall 2012 Bruce D. Kothmann Balancing g Robot Control MEAM 510 Fall 2012 Bruce D. Kothmann Agenda Bruce s Controls Resume Simple Mechanics (Statics & Dynamics) of the Balancing Robot Basic Ideas About Feedback & Stability Effects

More information

Nonlinear Control of a Quadrotor Micro-UAV using Feedback-Linearization

Nonlinear Control of a Quadrotor Micro-UAV using Feedback-Linearization Proceedings of the 2009 IEEE International Conference on Mechatronics. Malaga, Spain, April 2009. Nonlinear Control of a Quadrotor Micro-UAV using Feedback-Linearization Holger Voos University of Applied

More information

MEAM 510 Fall 2011 Bruce D. Kothmann

MEAM 510 Fall 2011 Bruce D. Kothmann Balancing g Robot Control MEAM 510 Fall 2011 Bruce D. Kothmann Agenda Bruce s Controls Resume Simple Mechanics (Statics & Dynamics) of the Balancing Robot Basic Ideas About Feedback & Stability Effects

More information

Nonlinear and Neural Network-based Control of a Small Four-Rotor Aerial Robot

Nonlinear and Neural Network-based Control of a Small Four-Rotor Aerial Robot Nonlinear and Neural Network-based Control of a Small Four-Rotor Aerial Robot Holger Voos Abstract Small four-rotor aerial robots, so called quadrotor UAVs, have an enormous potential for all kind of neararea

More information

Dynamic Modeling of Rotary Double Inverted Pendulum Using Classical Mechanics

Dynamic Modeling of Rotary Double Inverted Pendulum Using Classical Mechanics ISBN 978-93-84468-- Proceedings of 5 International Conference on Future Computational echnologies (ICFC'5) Singapore, March 9-3, 5, pp. 96-3 Dynamic Modeling of Rotary Double Inverted Pendulum Using Classical

More information

Near-Hover Dynamics and Attitude Stabilization of an Insect Model

Near-Hover Dynamics and Attitude Stabilization of an Insect Model 21 American Control Conference Marriott Waterfront, Baltimore, MD, USA June 3-July 2, 21 WeA1.4 Near-Hover Dynamics and Attitude Stabilization of an Insect Model B. Cheng and X. Deng Abstract In this paper,

More information

ME 132, Dynamic Systems and Feedback. Class Notes. Spring Instructor: Prof. A Packard

ME 132, Dynamic Systems and Feedback. Class Notes. Spring Instructor: Prof. A Packard ME 132, Dynamic Systems and Feedback Class Notes by Andrew Packard, Kameshwar Poolla & Roberto Horowitz Spring 2005 Instructor: Prof. A Packard Department of Mechanical Engineering University of California

More information

Modeling of a Hexapod Robot; Kinematic Equivalence to a Unicycle

Modeling of a Hexapod Robot; Kinematic Equivalence to a Unicycle Modeling of a Hexapod Robot; Kinematic Equivalence to a Unicycle Dimitra Panagou, Herbert Tanner, {dpanagou, btanner}@udel.edu Department of Mechanical Engineering, University of Delaware Newark DE, 19716

More information

Control of the MARES Autonomous Underwater Vehicle

Control of the MARES Autonomous Underwater Vehicle Control of the MARES Autonomous Underwater Vehicle Bruno Ferreira, Miguel Pinto, Aníbal Matos, Nuno Cruz FEUP DEEC Rua Dr. Roberto Frias, s/n 4200-465 Porto PORTUGAL ee04018@fe.up.pt, ee04134@fe.up.pt,

More information

UAV Coordinate Frames and Rigid Body Dynamics

UAV Coordinate Frames and Rigid Body Dynamics Brigham Young University BYU ScholarsArchive All Faculty Publications 24-- UAV oordinate Frames and Rigid Body Dynamics Randal Beard beard@byu.edu Follow this and additional works at: https://scholarsarchive.byu.edu/facpub

More information

AA 242B/ ME 242B: Mechanical Vibrations (Spring 2016)

AA 242B/ ME 242B: Mechanical Vibrations (Spring 2016) AA 242B/ ME 242B: Mechanical Vibrations (Spring 2016) Homework #2 Due April 17, 2016 This homework focuses on developing a simplified analytical model of the longitudinal dynamics of an aircraft during

More information

Aircraft Maneuver Regulation: a Receding Horizon Backstepping Approach

Aircraft Maneuver Regulation: a Receding Horizon Backstepping Approach Aircraft Maneuver Regulation: a Receding Horizon Backstepping Approach Giuseppe Notarstefano and Ruggero Frezza Abstract Coordinated flight is a nonholonomic constraint that implies no sideslip of an aircraft.

More information

Flight and Orbital Mechanics

Flight and Orbital Mechanics Flight and Orbital Mechanics Lecture slides Challenge the future 1 Flight and Orbital Mechanics Lecture 7 Equations of motion Mark Voskuijl Semester 1-2012 Delft University of Technology Challenge the

More information

The Role of Zero Dynamics in Aerospace Systems

The Role of Zero Dynamics in Aerospace Systems The Role of Zero Dynamics in Aerospace Systems A Case Study in Control of Hypersonic Vehicles Andrea Serrani Department of Electrical and Computer Engineering The Ohio State University Outline q Issues

More information

Adaptive Robust Control (ARC) for an Altitude Control of a Quadrotor Type UAV Carrying an Unknown Payloads

Adaptive Robust Control (ARC) for an Altitude Control of a Quadrotor Type UAV Carrying an Unknown Payloads 2 th International Conference on Control, Automation and Systems Oct. 26-29, 2 in KINTEX, Gyeonggi-do, Korea Adaptive Robust Control (ARC) for an Altitude Control of a Quadrotor Type UAV Carrying an Unknown

More information

Mechanics of Flight. Warren F. Phillips. John Wiley & Sons, Inc. Professor Mechanical and Aerospace Engineering Utah State University WILEY

Mechanics of Flight. Warren F. Phillips. John Wiley & Sons, Inc. Professor Mechanical and Aerospace Engineering Utah State University WILEY Mechanics of Flight Warren F. Phillips Professor Mechanical and Aerospace Engineering Utah State University WILEY John Wiley & Sons, Inc. CONTENTS Preface Acknowledgments xi xiii 1. Overview of Aerodynamics

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

Localizer Hold Autopilot

Localizer Hold Autopilot Localizer Hold Autopilot Prepared by A.Kaviyarasu Assistant Professor Department of Aerospace Engineering Madras Institute Of Technology Chromepet, Chennai Localizer hold autopilot is one of the important

More information

FLIGHT DYNAMICS. Robert F. Stengel. Princeton University Press Princeton and Oxford

FLIGHT DYNAMICS. Robert F. Stengel. Princeton University Press Princeton and Oxford FLIGHT DYNAMICS Robert F. Stengel Princeton University Press Princeton and Oxford Preface XV Chapter One Introduction 1 1.1 ELEMENTS OF THE AIRPLANE 1 Airframe Components 1 Propulsion Systems 4 1.2 REPRESENTATIVE

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

ARW Lecture 04 Point Tracking

ARW Lecture 04 Point Tracking ARW Lecture 04 Point Tracking Instructor: Chris Clark Semester: Summer 2016 1 Figures courtesy of Siegwart & Nourbakhsh Planning Based Control Prior Knowledge Operator Commands Localization Path Planning

More information

Backstepping and Sliding-mode Techniques Applied to an Indoor Micro Quadrotor

Backstepping and Sliding-mode Techniques Applied to an Indoor Micro Quadrotor Proceedings of the 2005 IEEE International Conference on Robotics and Automation Barcelona, Spain, April 2005 Backstepping and Sliding-mode Techniques Applied to an Indoor Micro Quadrotor Samir Bouabdallah

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

Autonomous Helicopter Landing A Nonlinear Output Regulation Perspective

Autonomous Helicopter Landing A Nonlinear Output Regulation Perspective Autonomous Helicopter Landing A Nonlinear Output Regulation Perspective Andrea Serrani Department of Electrical and Computer Engineering Collaborative Center for Control Sciences The Ohio State University

More information

Modeling the 3-DOF Dynamics of an Electrodynamic Maglev Suspension System with a Passive Sled

Modeling the 3-DOF Dynamics of an Electrodynamic Maglev Suspension System with a Passive Sled Modeling the 3-DOF Dynamics of an Electrodynamic Maglev Suspension System with a Passive Sled Jeroen de Boeij 3, Héctor Gutiérrez *1, Rahul Agarwal 2 and Maarten Steinbuch 3 1 Department of Mechanical

More information

Sliding Mode Control Strategies for Spacecraft Rendezvous Maneuvers

Sliding Mode Control Strategies for Spacecraft Rendezvous Maneuvers Osaka University March 15, 2018 Sliding Mode Control Strategies for Spacecraft Rendezvous Maneuvers Elisabetta Punta CNR-IEIIT, Italy Problem Statement First Case Spacecraft Model Position Dynamics Attitude

More information

6. 3D Kinematics DE2-EA 2.1: M4DE. Dr Connor Myant

6. 3D Kinematics DE2-EA 2.1: M4DE. Dr Connor Myant DE2-EA 2.1: M4DE Dr Connor Myant 6. 3D Kinematics Comments and corrections to connor.myant@imperial.ac.uk Lecture resources may be found on Blackboard and at http://connormyant.com Contents Three-Dimensional

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

Aircraft Flight Dynamics & Vortex Lattice Codes

Aircraft Flight Dynamics & Vortex Lattice Codes Aircraft Flight Dynamics Vortex Lattice Codes AA241X April 14 2014 Stanford University Overview 1. Equations of motion 2. Non-dimensional EOM Aerodynamics 3. Trim Analysis Longitudinal Lateral 4. Linearized

More information

The written qualifying (preliminary) examination covers the entire major field body of knowledge

The written qualifying (preliminary) examination covers the entire major field body of knowledge Dynamics The field of Dynamics embraces the study of forces and induced motions of rigid and deformable material systems within the limitations of classical (Newtonian) mechanics. The field is intended

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

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

Problem 1: Ship Path-Following Control System (35%)

Problem 1: Ship Path-Following Control System (35%) Problem 1: Ship Path-Following Control System (35%) Consider the kinematic equations: Figure 1: NTNU s research vessel, R/V Gunnerus, and Nomoto model: T ṙ + r = Kδ (1) with T = 22.0 s and K = 0.1 s 1.

More information

Chapter 4 Statics and dynamics of rigid bodies

Chapter 4 Statics and dynamics of rigid bodies Chapter 4 Statics and dynamics of rigid bodies Bachelor Program in AUTOMATION ENGINEERING Prof. Rong-yong Zhao (zhaorongyong@tongji.edu.cn) First Semester,2014-2015 Content of chapter 4 4.1 Static equilibrium

More information

ENHANCED PROPORTIONAL-DERIVATIVE CONTROL OF A MICRO QUADCOPTER

ENHANCED PROPORTIONAL-DERIVATIVE CONTROL OF A MICRO QUADCOPTER ENHANCED PROPORTIONAL-DERIVATIVE CONTROL OF A MICRO QUADCOPTER Norman L. Johnson and Kam K. Leang Department of Mechanical Engineering University of Nevada, Reno Reno, Nevada 897-312, USA ABSTRACT This

More information

(Refer Slide Time: 00:01:30 min)

(Refer Slide Time: 00:01:30 min) Control Engineering Prof. M. Gopal Department of Electrical Engineering Indian Institute of Technology, Delhi Lecture - 3 Introduction to Control Problem (Contd.) Well friends, I have been giving you various

More information

A SIMPLIFIED ANALYSIS OF NONLINEAR LONGITUDINAL DYNAMICS AND CONCEPTUAL CONTROL SYSTEM DESIGN

A SIMPLIFIED ANALYSIS OF NONLINEAR LONGITUDINAL DYNAMICS AND CONCEPTUAL CONTROL SYSTEM DESIGN A SIMPLIFIED ANALYSIS OF NONLINEAR LONGITUDINAL DYNAMICS AND CONCEPTUAL CONTROL SYSTEM DESIGN ROBBIE BUNGE 1. Introduction The longitudinal dynamics of fixed-wing aircraft are a case in which classical

More information