Hybrid Controller for an Unmanned Ground Vehicle with Non-linear/Hybrid Dynamics

Size: px
Start display at page:

Download "Hybrid Controller for an Unmanned Ground Vehicle with Non-linear/Hybrid Dynamics"

Transcription

1 Hybrid Controller for an Unmanned Ground Vehicle with Non-linear/Hybrid Dynamics James Goppert School of Aeronautics and Astronautics Engineering Purdue University West Lafayette, Indiana Brandon Wampler School of Aeronautics and Astronautics Engineering Purdue University West Lafayette, Indiana Abstract This report presents a method of controlling an unmanned ground vehicel (UGV) by employing hybrid control theory. The linear dynamics of the UGV near a straight path conform to modern linear quadratic regulator theory. Two different methods for regulation of the UGV on a straight track are analyzed. The first method employs the steering angle as an input, while the second employs the derivative of the steering angle as the input. While steering angle feedback offers a solution of lower state dimension, it was found that the noise in the steering angle command was too large for driving typical servo motors. When the UGV is turning the linear dynamics are violated. At the accelerations required for our UGV during cornering, side slip cannot be neglected. As the vehicle skids while cornering, linear assumptions are violated. Various surfaces can also change the cornering accelerations at which significant tire slip occurs. A simple yaw rate feedback PID controller is employed in an attempt to maintain a constant acceleration during the turn and ensure system robustness to environemental variations. Due to the continuous motion of the vehicle, the discrete modes of the controller, and the discrete properties of the UGV s transmission, the system must be controlled considering hybrid automaton theory. A switching scheme is therefore developed to effectively switch between the straight mode s linear quadratic regulator control and the turning modes yaw rate feedback PID control. Fig. 1. Modelled Unmanned Ground Vehicle I. INTRODUCTION Controlling a vehicle to follow a desired path through an environment can be approached in several different ways. The first is to have a path planning algorithm decide the trip and then use a tracker controller to follow the trajectory. This can be complex when considering the computation cost to calculate a continuous trajectory. We implemented a hybrid approach to controlling a car along a desired path in order to simplify the problem and offer several advantages that will be mentioned later. A simpler navigation method would be to assign key waypoints and then navigate between them while rounding the vertices for a smooth driving. This system is hybrid due to the discrete modes used to accomplish the goal and model the system. Straight line segment tracks allow us to place our control coordinate system on the line and make the problem simpler by using a Linear Quadratic Regulator instead of a Linear Quadratic Tracker. We then used a classical PID controller to try and maintain constant lateral acceleration when transitioning to different straight tracks. A. Radius of Curvature Tracking Tracking predefined smooth trajectories is a well developed field in robotics. These trajectories require computation of splines of various orders to connect waypoints along a desired path. The radius of curvature of the path is used to track the curvature of the road and maintain zero cross track. An example of this system is developed in [2], [3], [4], and [5] B. Steering Law Tracking Recent development for the DARPA Grand Challenge for unmanned ground vehicles has resulted in signficant progress. Instead of tracking a desired trajectory directly by minimizing crosstrack, several researchs have chosen to track a desired steering command. The steering command is chosen to be globally stable. This method offers a fast robust solution that has been proven in offroad and racing vehicles. The disadvantage is that global optimality of the path is sacrificed. The steering law depends primarily upon the current state of

2 the vehicle and deviation from the current path. It is not well suited for a look ahead control strategy which would allow higher vehicle performance. C. Contribution The contribution of this paper is that a computationally efficient, yet robust method is developed that can handle nonlinearities associated with tire slip. This method has look ahead capability through the use of a dynamic switching guard used to initialize turns. The simplicity of the waypoint tracking scheme also makes the behaviour predictable for intefacing with human controllers. When applied to the field of obstacle avoidance this method can also be easily interfaced with a locally and globally optimal path finding algorithm. II. HYBRID NONLINEAR DYNAMIC MODEL Fig. 2. UGV Forces and Moments A. Vehicle Paramters The vehicle modelled in this paper has the following parameters: m 3.kg (mass) Iz.6kg m 2 (moment of inertia) C α.16/deg (cornering stiffness) (Smith,23) f d.31/s (drive train drag coefficient) The mass is high due to the onboard processing and sensors. The moment of inertia was estimated given the vehicle mass and geometry. The drive train drag coefficient was assumed to be proportional to velocity. This was done to match the energy dissipation of the drive train when throttle was not applied. The cornering stiffness was referenced from [1] for a standard tire. B. Forces and Moments The state space model used to simulate and control the car is a linearized version of a nonlinear dynamic model. The nonlinear model comes from a simple force model shown in Fig. 2. It is assumed that the forces acting on the tires are proportional to the side slip angles represented by β. The forces on the tires of the same axle are assumed to be equal to each other as well. The forces on the front and rear tires are given by equations eqns. The tangents of the sideslip angles can then be defined by Eq. 2. The deviation system about the reference state of a straight path is then found by linearization about this state. The first order taylor series expansion provides a linear equation for side slip. The longitudinal forces are modelled as the difference from the drive train force and the product of the drag coefficient and the longitudinal velocity. As seen in Eq. 2. ΣF x = F d f d V x F f = 2 C αf (δ β f ) (1) F r = 2 C αr ( β r ) (2) where δ - steering angle C αf/r - cornering stiffness β f/r - side slip The sideslip kinematic equations govern the lateral forces of the tire. In order for the model to be robust, it is important that the side slip angles be well approximated by a linear function within typical steering angles (for our vehicle +/- 3 degrees. tanβ f = (V y + l f ψ)/v x tanβ r = (V y + l r ψ)/v x using small angle approximations β f = (ẏ + l f ψ)/v x β r = (ẏ + l r ψ)/v x where V x - longitudinal velocity V y - lateral velocity ψ - heading angle rate Since tangent can be well approximated (within 1%) as linear over the range +/- 3 degrees, the controller should be robust near a zero side slip reference trajectory. C. Hybrid Transmission Model The transmission of the car was modeled as a hybrid system since it has three discrete modes of operation, forward, reverse, and neutral. To model the response of the speed controller in our RC test car, we used a transfer function shown by Eq. 3 to give the drive train a more realistic behavior. Also, for our RC car the speed control must remain in neutral for 1 second before switching from forward to reverse or visa versa. This delay can be seen in the neutral mode block in Fig. 3, a certain time constraint has to be met before the transmission will switch to forward or reverse. The delay in the neutral mode is a design feature of the speed controller of the RC car. This feature prevents zeno switching executions which could lead to burn out of the DC brush motor.

3 B. Speed Control Fig. 3. D. Hybrid Automaton Definition Transmission Stateflow Diagram Using the previous information, we develop a hybrid automaton defined by the following variables. H = (Q, X, σ, V, Init, f, Inv, R, G) where: Q - discrete modes: throttle (forward, neutral, reverse) X - continous states: position and velocity of UGV σ - discrte input: steering (left, right, straight) waypoint(next, current, intermediate) V - continuous input variables: throttle command, yaw rate command (during turn mode) Init - initial state: vehicle must be on ground for dynamic model assumptions to be valid f - vector field for evolution of continuous dynamics: the vehicle nonlinear dynamic model Inv - invariant set: combination of states and inputs for which continous evolution is allowed R - reset relations: as described in statflow schematics G - guards for transitions on discrete states Q and σ III. PID DESIGN OF SPEED CONTROL AND TURN MODES A PID controller was used to control the velocity of the car and also to sustain the turns when transitioning between waypoint tracks. The velocity is controlled by feeding back the velocity error and tuning the PID until we reached a rise time of 1 second without excessive overshoot or oscillation. A similar procedure was used for tuning the PID of the turn mode. In this case yaw rate error was fed back. The desired yaw rate was calculated based on turn radius and velocity discussed in the next section. The PID controller on yaw rate allows us to react to slipping and sliding of the car around corners while still trying to maintain a desired yaw rate without excessive oscillation. A. Servo Plant Model Equation 3 is the model of the servo dynamics for both the throttle servo and the steering servo. The transfer function essentially acts a low pass filter reducing noise significantly that is over 1 Hz. The initial and final value theorem ensure that the transfer function tracks the input command proportionally. The speed control loop uses velocity error feedback and a PID controller. The gains of the PID controller are set to have a fast rise time to ensure turning initiates at the point a turn is commanded. This rise time is important to the hybrid system because it effects the switching behaviour of the system. Where higher precision is needed this rise time could be modelled as a transient state in the hybrid system between the straight and turn mode. C. Turn Modes 1 s + 1 When in either the left or the right turn mode the vehicle attempts to maintain a constant turn acceleration. The acceleration is maintained by yaw rate feedback routed to the steering angle input. Again, the rise time is important to ensure that the switching can be approximated as instantaneous. As in the speed control loop the transient response of the controller can be modelled in an intermediate mode between the straight and turn mode. IV. LQR DESIGN OF STRAIGHT MODE The straight mode consists of a LQR with full state feedback to control heading and cross track. The LQR requires a linear system so we convert our system to a linear deviation system, linearized about zero heading and zero cross track. The linear deviation system is given by Eq. 4. A. Available Feedback A simulated INS system is used to provide position, velocity, acceleration, heading, and roll rate estimates to the system. The linear deviation system about the reference trajectory requires several specific states. First, for the longitudinal control the longitudinal velocity V x is required. This velocity is fedback for the feedback to the speed controller. Also V x can be used to gain schedule the LQR for various straight away velocities. For this paper only one straight away velocity was used (5m/s). The lateral system requires the cross track, the cross track velocity, the yaw angle, and the yaw rate angle. These states are all available from the INS unit but there is inherent noise in the system. You will notice in Fig. 17 that the cross track is not zero. This deviation is not a result of steady state error in the control scheme, but it is a result of INS error propagation in position. (3)

4 B. Linearization of UGV Dynamics 1 2C αf +2C αr 2C αf +2C αr mv x m 1 2C αf l f +2C αrl r 2C αf l f +2C αrl r I zv x I z ẋ = Ax + Bu x = e1 e1 e2 e2 2C αf l f +2C αrl r mv x 2C αf l 2 f +2Cαrl2 r I zv x 2C alphaf m 2C αf l f Iz A = B = where: u - delta, steering angle (input) e1 - error in crosstrack e2 - error in heading C αf/r - cornering stiffness for front/rear tire l f /r - distance to front/rear axel from c.g. I z - polar moment of inertia m - mass of vehicle V x - vehicle longitudinal velocity C. Continous Algebraic Ricatti Equation Formulation The LQR is formulated as follows for a continuous time system (x) = Ax + Bu with cost function J = (x Qx + u Ru)dt the cost minimizing feedback law is u = Kx where K is K = R 1 B P and P is found by solving the continuous time ARE A P + P A P BR 1 B P + Q = D. Performance Index Design Where K is the steady state Kalman gain. The LQR optimizes the response to minimize the cost given by the designed cost function. Our initial LQR design was as follows: Q=diag([1,1,1,1]) R=1 K1 = [ ] These gains gave us good path following but resulted in poor yaw damping. In order to remedy this, another LQR was designed with the following parameters: Q=diag([1,,1,8]) R=.5 K2=[ ] This design penalizes the yaw rate gives the system more control input freedom while neglecting the cross track velocity. This resulted in a better behavior when exiting turns with less yaw oscillation in the straight mode operation. The yaw rate plots for the two LQR designs in Fig. 4 and Fig. 5 show the improvement in yaw rate behavior. E. Steering Rate Feedback vs. Steering Angle Feedback Although behaviour of the system with steering angle feedback performed well, observation of the steering command revealed that the command exceeded the physical constraints of the system. Although the servo plant was filtering out high frequency inputs, the robustness of the LQR was violated due to the false assumption that the steering angle could be instantaneously commanded. It was therefore necessary to add the steering angle to the state and treat the derivative of the steering angle as a command to the system. Although the actual system accepts a steering angle command to the servo motor, the LQR optimized gain may be applied by integrating the LQR feedback (steering angle rate) to get the steering angle. The previous LQR derivation requires a slight modificatoin given below where A and B are the same as those defined previously: Ap = [A, B;, ]Bp = [; ; ; ; 1] For an initial stable design point Q and R were chosen as the identity matrix. The solution of the continuous algebraic ricatti equation yields the following gain: K = [ ] closed loop poles i i yaw poles i i cross track poles -1. delta poles (steering) As can be observed from the steering history and yaw rate history for the initial stable design, the yaw rate is too high. This can also be observed by the slow yaw poles. By penalizing the yaw rate and yaw position more heavily we can drive the closed loop poles of the yaw further negative. A design point was chosen where the cross track and yaw poles were approximately at the same position along the negative real axis. This ensures the system has a higher time constant for input decay. K = [ ] closed loop poles i i yaw poles delta poles (steering) i i cross track poles Note that the steering angle is less stable, but the overall performance improves due to the yaw and cross track poles since they dominate the system. The yaw poles also have a higher frequency that the cross track poles. It is important that the turn does not excite the resonant frequency of these modes.

5 1 Heading Rate, undesigned 3 Tire Side Slip, designed ψ dot, deg/s β, deg Front Rear Fig. 4. Undesigned Heading Rate Response Fig. 6. Undesigned Tire Slip Angle (β) Response Heading Rate, designed 3 2 Tire Side Slip, designed Front Rear ψ dot, deg/s β, deg Fig. 5. Designed Heading Rate Response Fig. 7. Designed Tire Slip Angle (β) Response This can be avoided through choice of centripetal acceleration. The designed heading rate and tire slip oscillations are both quickly dampled using the modified LQR gains obtained through penalization of the yaw and yaw rate. V. WAYPOINT AND STEERING SWITCHING SCHEMES A. Waypoint Switching In order to make a smooth transition between desired paths, we designed a dynamic waypoint guard that changes based the vehicles current state, direction of the next desired track, and the lateral acceleration desire for the turn. More specifically the guard is a function of the vehicles velocity, angle between current heading and the heading of the next desired track, and the lateral acceleration deemed appropriate for the turn. When the car crosses the longitudinal distance x from the waypoint it is currently tracking, it causes a discrete switch to the next waypoint and a path to follow is drawn. The faster the car is going and the sharper the turn, the further out it will switch to allow more room to turn at the desired rate and still maintain a desired lateral accelleration The equations that govern the guard position x shown in Fig. 8 are: v = R ψ R = v2 a c tan(α/2) = x R x = v2 a c tan(α/2) where: a c - centripetal acceleration

6 Fig. 8. State Dependent Waypoint Guard v - velocity R - radius of curvature α - change in heading angle x - waypoint transition guard The waypoint dynamic guard calculations assume that if there is no sideslip present, the car will transition between the two tracks perfectly along the radius R if the yaw rate ψ is maintained throughout the whole turn. Since there is sideslip allowed in our model, and a PID is used to control the yaw rate of the turn, we usually end up with a little overshoot by sliding beyond the track before the heading of the car matches the track and the LQR takes over. The rise time of the PID controller for yaw rate and velocity also contribute to this overshoot. The waypoint switching diagram is shown in Fig. 9. The guards are along the switching lines and inside of each mode bubble is the set of instructions to execute. In addition to the dynamic longitudinal guard discussed earlier, a lateral guard condition must be met to ensure the car is close to the current track before executing a turn to the next. The intermediate waypoint mode in the bottom of the Fig. 9 is a safety measure to ensure that the desired path can be tracked even if there are large deviations. If the car switches to a new waypoint and is further away than a set minimum, the guidance system will create an intermediate waypoint to drive the car perpendicular to the track until it is close enough to resume normal tracking. B. Steering Mode Control The guard that controls the steering modes is set up in an overlapping fashion as shown in Fig 1. If the heading of the car is more than 2 deg. from the desired path, the car will switch into left or right turning mode to realign itself. When the heading eventually matches that of the desired track Fig. 9. Waypoint Control Stateflow Diagram within 1 deg., the straight mode takes over and the crosstrack LQR quickly corrects the cars position and heading to the desired track. This overlapping guard gives the LQR enough room to operate without switching out immediately after a control is applied as a non overlapping guard would do. The reason for switching to a turning mode is to correct large heading deviations where the linearized model, linearized about zero cross-track and zero heading error, is no longer a valid assumption. The corresponding state flow diagram for the turning modes is shown in Fig. 11. The guard conditions are seen along the transition lines between each of the modes. VI. SIMULATION RESULTS A position drifting behavior is present when running our simulations. This is due to the errors modeled into the inertial navigation system (INS). These errors integrated over time cause a drift in the estimated position away from the actual position. This error propagation is shown in Fig. 15. All three axes exhibit an unstable estimation behavior. This is due to the position information being taken directly from the double integration of the accelerations and moments in the inertial measurement unit including errors. The errors are also visible in the path history shown in Fig. 17. The vehicle is at the end of the loop which is also the start. Notice it thinks it is in the same position that is started in when in fact it is slightly off. The position error starts low and gradually grows. If allowed to continue uncorrected the error will continue to grow without bound. Usually another system is used to correct errors in INS systems such as GPS or another external measurement. In our case, our future work involves using imaging and optical flow to identify and localize landmarks. These landmark points

7 6 Measured Acceleration, designed 4 2 A, m/s Fig. 12. Measured Acceleration Fig. 1. Steering Guard 3 2 Steering Angle, designed 1 delta, deg 1 2 Fig. 11. Steering Control Stateflow Diagram will be grouped into plane landmarks to represent the sides of buildings. We plan on using a Kalman filter to integrate the INS and visual measurements since both are stochastic in nature. There is definitely noise in the INS as discussed earlier. There is also uncertainty in the precision of the measurements coming into the system. These uncertainties in the INS and measurements are represented by covariance matrices. Kalman filters handle these types of problems well, especially when the noise can be assumed to be Gaussian in nature. VII. INS MODEL AND FUTURE WORK The INS model used for the state estimation in this paper assumed the following parameters that were thought to be indicative of medium grade INS systems: scale factor - 1 (uncorrellated) bias - Fig. 13. Steering Angle noise level - IMU : 1e 4m/s 2, GY ROS : 1e 4rad/s In future work we hope to integrate the current INS based estimation and control test bed with another external position estimate for the system. This external position estimate will make the system detectable. Current instruments that are being considered are vision cameras and LIDAR (light detection and ranging) scanners. In an environment where GPS is denied, such as a battlefield or large cities, the ability to localize with respect to the local environment will make unamnned systems more robust. REFERENCES [1] Smith, Nicholas; Understanding Parameters Influencing Tire Modelling, Colorado State University, 24 Formula SAE Platform

8 INS roll, pitch, yaw error propagation, designed error, m Fig. 14. Virtual Reality Test-bed INS position error propagation, designed.5.5 deg Fig. 16. roll pitch yaw Roll, Pitch, Yaw Error 1 N E D Fig. 15. Position Error [2] Rajamani, r.; Vehicle Dynamics and Control, Springer, 26, ISBN: [3] Freunc, Eckhard; Mayr, Rober; Nonlinear Path Control in Automated Vehicle Guidance, IEEE Transactions on Robotics and Automation, vol. 13, no. 1, February 1997, 49. [4] Ben Amar, Faiz, Steering behaviour and control of fast wheeled robots, Laboratoire de Robotique de Paris [5] Hoffmann, Gabriel M.; Autonomous Automobile Trajectory Tracking for Off-Road Driving Controller Design, Experimental Validation and Racing, 27. Fig. 17. Trajectory for LQR with Designed Performance Indices

A Simplified Vehicle and Driver Model for Vehicle Systems Development

A Simplified Vehicle and Driver Model for Vehicle Systems Development A Simplified Vehicle and Driver Model for Vehicle Systems Development Martin Bayliss Cranfield University School of Engineering Bedfordshire MK43 0AL UK Abstract For the purposes of vehicle systems controller

More information

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

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

More information

A Nonlinear Model Predictive Control Algorithm for an Unmanned Ground Vehicle on Variable Terrain. Andrew Eick

A Nonlinear Model Predictive Control Algorithm for an Unmanned Ground Vehicle on Variable Terrain. Andrew Eick A Nonlinear Model Predictive Control Algorithm for an Unmanned Ground Vehicle on Variable Terrain by Andrew Eick A thesis submitted to the Graduate Faculty of Auburn University in partial fulfillment of

More information

A Longitudinal Control Algorithm for Smart Cruise Control with Virtual Parameters

A Longitudinal Control Algorithm for Smart Cruise Control with Virtual Parameters ISSN (e): 2250 3005 Volume, 06 Issue, 12 December 2016 International Journal of Computational Engineering Research (IJCER) A Longitudinal Control Algorithm for Smart Cruise Control with Virtual Parameters

More information

EE565:Mobile Robotics Lecture 2

EE565:Mobile Robotics Lecture 2 EE565:Mobile Robotics Lecture 2 Welcome Dr. Ing. Ahmad Kamal Nasir Organization Lab Course Lab grading policy (40%) Attendance = 10 % In-Lab tasks = 30 % Lab assignment + viva = 60 % Make a group Either

More information

Unit 2: Locomotion Kinematics of Wheeled Robots: Part 3

Unit 2: Locomotion Kinematics of Wheeled Robots: Part 3 Unit 2: Locomotion Kinematics of Wheeled Robots: Part 3 Computer Science 4766/6778 Department of Computer Science Memorial University of Newfoundland January 28, 2014 COMP 4766/6778 (MUN) Kinematics of

More information

CMPUT 412 Motion Control Wheeled robots. Csaba Szepesvári University of Alberta

CMPUT 412 Motion Control Wheeled robots. Csaba Szepesvári University of Alberta CMPUT 412 Motion Control Wheeled robots Csaba Szepesvári University of Alberta 1 Motion Control (wheeled robots) Requirements Kinematic/dynamic model of the robot Model of the interaction between the wheel

More information

This was written by a designer of inertial guidance machines, & is correct. **********************************************************************

This was written by a designer of inertial guidance machines, & is correct. ********************************************************************** EXPLANATORY NOTES ON THE SIMPLE INERTIAL NAVIGATION MACHINE How does the missile know where it is at all times? It knows this because it knows where it isn't. By subtracting where it is from where it isn't

More information

A Reactive Bearing Angle Only Obstacle Avoidance Technique for Unmanned Ground Vehicles

A Reactive Bearing Angle Only Obstacle Avoidance Technique for Unmanned Ground Vehicles Proceedings of the International Conference of Control, Dynamic Systems, and Robotics Ottawa, Ontario, Canada, May 15-16 2014 Paper No. 54 A Reactive Bearing Angle Only Obstacle Avoidance Technique for

More information

THE PENNSYLVANIA STATE UNIVERSITY SCHREYER HONORS COLLEGE DEPARTMENT OF ELECTRICAL ENGINEERING

THE PENNSYLVANIA STATE UNIVERSITY SCHREYER HONORS COLLEGE DEPARTMENT OF ELECTRICAL ENGINEERING THE PENNSYLVANIA STATE UNIVERSITY SCHREYER HONORS COLLEGE DEPARTMENT OF ELECTRICAL ENGINEERING TRAJECTORY FOLLOWING CONTROL ALGORITHM FOR GROUND ROBOTS NAVIGATING PLANNING ALGORITHM PATHS MATTHEW MALENCIA

More information

Autonomous Mobile Robots Using Real Time Kinematic Signal Correction and Global Positioning System Control

Autonomous Mobile Robots Using Real Time Kinematic Signal Correction and Global Positioning System Control Paper 087, IT 304 Autonomous Mobile Robots Using Real Time Kinematic Signal Correction and Global Positioning System Control Thongchai Phairoh, Keith Williamson Virginia State University tphairoh@vsu.edu

More information

Robotics (Kinematics) Winter 1393 Bonab University

Robotics (Kinematics) Winter 1393 Bonab University Robotics () Winter 1393 Bonab University : most basic study of how mechanical systems behave Introduction Need to understand the mechanical behavior for: Design Control Both: Manipulators, Mobile Robots

More information

(1) and s k ωk. p k vk q

(1) and s k ωk. p k vk q Sensing and Perception: Localization and positioning Isaac Sog Project Assignment: GNSS aided INS In this project assignment you will wor with a type of navigation system referred to as a global navigation

More information

Beikrit Samia Falaschini Clara Abdolhosseini Mahyar Capotescu Florin. Qball Quadrotor Helicopter

Beikrit Samia Falaschini Clara Abdolhosseini Mahyar Capotescu Florin. Qball Quadrotor Helicopter Beikrit Samia Falaschini Clara Abdolhosseini Mahyar Capotescu Florin Qball Quadrotor Helicopter Flight Control Systems Project : Objectives for the Qball quadrotor helicopter 1) Develop non linear and

More information

Development of a Ground Based Cooperating Spacecraft Testbed for Research and Education

Development of a Ground Based Cooperating Spacecraft Testbed for Research and Education DIPARTIMENTO DI INGEGNERIA INDUSTRIALE Development of a Ground Based Cooperating Spacecraft Testbed for Research and Education Mattia Mazzucato, Sergio Tronco, Andrea Valmorbida, Fabio Scibona and Enrico

More information

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

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

More information

Chapter 4 Dynamics. Part Constrained Kinematics and Dynamics. Mobile Robotics - Prof Alonzo Kelly, CMU RI

Chapter 4 Dynamics. Part Constrained Kinematics and Dynamics. Mobile Robotics - Prof Alonzo Kelly, CMU RI Chapter 4 Dynamics Part 2 4.3 Constrained Kinematics and Dynamics 1 Outline 4.3 Constrained Kinematics and Dynamics 4.3.1 Constraints of Disallowed Direction 4.3.2 Constraints of Rolling without Slipping

More information

CANAL FOLLOWING USING AR DRONE IN SIMULATION

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

More information

Centre for Autonomous Systems

Centre for Autonomous Systems Robot Henrik I Centre for Autonomous Systems Kungl Tekniska Högskolan hic@kth.se 27th April 2005 Outline 1 duction 2 Kinematic and Constraints 3 Mobile Robot 4 Mobile Robot 5 Beyond Basic 6 Kinematic 7

More information

Robotics: Science and Systems

Robotics: Science and Systems Robotics: Science and Systems Model Predictive Control (MPC) Zhibin Li School of Informatics University of Edinburgh Content Concepts of MPC MPC formulation Objective function and constraints Solving the

More information

Optimal Path Finding for Direction, Location and Time Dependent Costs, with Application to Vessel Routing

Optimal Path Finding for Direction, Location and Time Dependent Costs, with Application to Vessel Routing 1 Optimal Path Finding for Direction, Location and Time Dependent Costs, with Application to Vessel Routing Irina S. Dolinskaya Department of Industrial Engineering and Management Sciences Northwestern

More information

Final Exam Practice Fall Semester, 2012

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

More information

Attack Resilient State Estimation for Vehicular Systems

Attack Resilient State Estimation for Vehicular Systems December 15 th 2013. T-SET Final Report Attack Resilient State Estimation for Vehicular Systems Nicola Bezzo (nicbezzo@seas.upenn.edu) Prof. Insup Lee (lee@cis.upenn.edu) PRECISE Center University of Pennsylvania

More information

Engineering Tool Development

Engineering Tool Development Engineering Tool Development Codification of Legacy Three critical challenges for Indian engineering industry today Dr. R. S. Prabakar and Dr. M. Sathya Prasad Advanced Engineering 21 st August 2013 Three

More information

Apprenticeship Learning for Reinforcement Learning. with application to RC helicopter flight Ritwik Anand, Nick Haliday, Audrey Huang

Apprenticeship Learning for Reinforcement Learning. with application to RC helicopter flight Ritwik Anand, Nick Haliday, Audrey Huang Apprenticeship Learning for Reinforcement Learning with application to RC helicopter flight Ritwik Anand, Nick Haliday, Audrey Huang Table of Contents Introduction Theory Autonomous helicopter control

More information

Vehicle Localization. Hannah Rae Kerner 21 April 2015

Vehicle Localization. Hannah Rae Kerner 21 April 2015 Vehicle Localization Hannah Rae Kerner 21 April 2015 Spotted in Mtn View: Google Car Why precision localization? in order for a robot to follow a road, it needs to know where the road is to stay in a particular

More information

Artificial Intelligence for Robotics: A Brief Summary

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

More information

S-SHAPED ONE TRAIL PARALLEL PARKING OF A CAR-LIKE MOBILE ROBOT

S-SHAPED ONE TRAIL PARALLEL PARKING OF A CAR-LIKE MOBILE ROBOT S-SHAPED ONE TRAIL PARALLEL PARKING OF A CAR-LIKE MOBILE ROBOT 1 SOE YU MAUNG MAUNG, 2 NU NU WIN, 3 MYINT HTAY 1,2,3 Mechatronic Engineering Department, Mandalay Technological University, The Republic

More information

NAVIGATION AND RETRO-TRAVERSE ON A REMOTELY OPERATED VEHICLE

NAVIGATION AND RETRO-TRAVERSE ON A REMOTELY OPERATED VEHICLE NAVIGATION AND RETRO-TRAVERSE ON A REMOTELY OPERATED VEHICLE Karl Murphy Systems Integration Group Robot Systems Division National Institute of Standards and Technology Gaithersburg, MD 0899 Abstract During

More information

Motion estimation of unmanned marine vehicles Massimo Caccia

Motion estimation of unmanned marine vehicles Massimo Caccia Motion estimation of unmanned marine vehicles Massimo Caccia Consiglio Nazionale delle Ricerche Istituto di Studi sui Sistemi Intelligenti per l Automazione Via Amendola 122 D/O, 70126, Bari, Italy massimo.caccia@ge.issia.cnr.it

More information

Effect of Uncertainties on UCAV Trajectory Optimisation Using Evolutionary Programming

Effect of Uncertainties on UCAV Trajectory Optimisation Using Evolutionary Programming 2007 Information, Decision and Control Effect of Uncertainties on UCAV Trajectory Optimisation Using Evolutionary Programming Istas F Nusyirwan 1, Cees Bil 2 The Sir Lawrence Wackett Centre for Aerospace

More information

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

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

More information

Parametric Study of Engine Rigid Body Modes

Parametric Study of Engine Rigid Body Modes Parametric Study of Engine Rigid Body Modes Basem Alzahabi and Samir Nashef C. S. Mott Engineering and Science Center Dept. Mechanical Engineering Kettering University 17 West Third Avenue Flint, Michigan,

More information

AUTONOMOUS PLANETARY ROVER CONTROL USING INVERSE SIMULATION

AUTONOMOUS PLANETARY ROVER CONTROL USING INVERSE SIMULATION AUTONOMOUS PLANETARY ROVER CONTROL USING INVERSE SIMULATION Kevin Worrall (1), Douglas Thomson (1), Euan McGookin (1), Thaleia Flessa (1) (1)University of Glasgow, Glasgow, G12 8QQ, UK, Email: kevin.worrall@glasgow.ac.uk

More information

10/11/07 1. Motion Control (wheeled robots) Representing Robot Position ( ) ( ) [ ] T

10/11/07 1. Motion Control (wheeled robots) Representing Robot Position ( ) ( ) [ ] T 3 3 Motion Control (wheeled robots) Introduction: Mobile Robot Kinematics Requirements for Motion Control Kinematic / dynamic model of the robot Model of the interaction between the wheel and the ground

More information

CHAPTER 3 MATHEMATICAL MODEL

CHAPTER 3 MATHEMATICAL MODEL 38 CHAPTER 3 MATHEMATICAL MODEL 3.1 KINEMATIC MODEL 3.1.1 Introduction The kinematic model of a mobile robot, represented by a set of equations, allows estimation of the robot s evolution on its trajectory,

More information

Motion Control (wheeled robots)

Motion Control (wheeled robots) Motion Control (wheeled robots) Requirements for Motion Control Kinematic / dynamic model of the robot Model of the interaction between the wheel and the ground Definition of required motion -> speed control,

More information

Spatio-Temporal Stereo Disparity Integration

Spatio-Temporal Stereo Disparity Integration Spatio-Temporal Stereo Disparity Integration Sandino Morales and Reinhard Klette The.enpeda.. Project, The University of Auckland Tamaki Innovation Campus, Auckland, New Zealand pmor085@aucklanduni.ac.nz

More information

IMPROVING QUADROTOR 3-AXES STABILIZATION RESULTS USING EMPIRICAL RESULTS AND SYSTEM IDENTIFICATION

IMPROVING QUADROTOR 3-AXES STABILIZATION RESULTS USING EMPIRICAL RESULTS AND SYSTEM IDENTIFICATION IMPROVING QUADROTOR 3-AXES STABILIZATION RESULTS USING EMPIRICAL RESULTS AND SYSTEM IDENTIFICATION Övünç Elbir & Electronics Eng. oelbir@etu.edu.tr Anıl Ufuk Batmaz & Electronics Eng. aubatmaz@etu.edu.tr

More information

Line of Sight Stabilization Primer Table of Contents

Line of Sight Stabilization Primer Table of Contents Line of Sight Stabilization Primer Table of Contents Preface 1 Chapter 1.0 Introduction 3 Chapter 2.0 LOS Control Architecture and Design 11 2.1 Direct LOS Stabilization 15 2.2 Indirect LOS Stabilization

More information

Waypoint Navigation with Position and Heading Control using Complex Vector Fields for an Ackermann Steering Autonomous Vehicle

Waypoint Navigation with Position and Heading Control using Complex Vector Fields for an Ackermann Steering Autonomous Vehicle Waypoint Navigation with Position and Heading Control using Complex Vector Fields for an Ackermann Steering Autonomous Vehicle Tommie J. Liddy and Tien-Fu Lu School of Mechanical Engineering; The University

More information

Estimation of Altitude and Vertical Velocity for Multirotor Aerial Vehicle using Kalman Filter

Estimation of Altitude and Vertical Velocity for Multirotor Aerial Vehicle using Kalman Filter Estimation of Altitude and Vertical Velocity for Multirotor Aerial Vehicle using Kalman Filter Przemys law G asior, Stanis law Gardecki, Jaros law Gośliński and Wojciech Giernacki Poznan University of

More information

Position and Attitude Alternate of Path Tracking Heading Control

Position and Attitude Alternate of Path Tracking Heading Control Sensors & Transducers, Vol. 167, Issue 3, March 014, pp. 03-09 Sensors & Transducers 014 by IFSA Publishing, S. L. http://www.sensorsportal.com Position and Attitude Alternate of Path Tracking Heading

More information

Lab 2: Real-Time Automotive Suspension system Simulator

Lab 2: Real-Time Automotive Suspension system Simulator ENGG*4420 Real Time System Design Lab 2: Real-Time Automotive Suspension system Simulator TA: Matthew Mayhew (mmayhew@uoguelph.ca) Due: Fri. Oct 12 th / Mon Oct 15 th ENGG*4420 1 Today s Activities Lab

More information

UItiMotion. Paul J. Gray, Ph.D. Manager Path Planning Front-End Design R&D

UItiMotion. Paul J. Gray, Ph.D. Manager Path Planning Front-End Design R&D UItiMotion Paul J. Gray, Ph.D. Manager Path Planning Front-End Design R&D What is UltiMotion? An entirely new software-based motion control system Wholly owned by Hurco Awarded 4 patents Superior to Hurco

More information

Design of a Three-Axis Rotary Platform

Design of a Three-Axis Rotary Platform Design of a Three-Axis Rotary Platform William Mendez, Yuniesky Rodriguez, Lee Brady, Sabri Tosunoglu Mechanics and Materials Engineering, Florida International University 10555 W Flagler Street, Miami,

More information

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

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

More information

Robust Controller Design for an Autonomous Underwater Vehicle

Robust Controller Design for an Autonomous Underwater Vehicle DRC04 Robust Controller Design for an Autonomous Underwater Vehicle Pakpong Jantapremjit 1, * 1 Department of Mechanical Engineering, Faculty of Engineering, Burapha University, Chonburi, 20131 * E-mail:

More information

Automated Parameterization of the Joint Space Dynamics of a Robotic Arm. Josh Petersen

Automated Parameterization of the Joint Space Dynamics of a Robotic Arm. Josh Petersen Automated Parameterization of the Joint Space Dynamics of a Robotic Arm Josh Petersen Introduction The goal of my project was to use machine learning to fully automate the parameterization of the joint

More information

Stochastic Road Shape Estimation, B. Southall & C. Taylor. Review by: Christopher Rasmussen

Stochastic Road Shape Estimation, B. Southall & C. Taylor. Review by: Christopher Rasmussen Stochastic Road Shape Estimation, B. Southall & C. Taylor Review by: Christopher Rasmussen September 26, 2002 Announcements Readings for next Tuesday: Chapter 14-14.4, 22-22.5 in Forsyth & Ponce Main Contributions

More information

Improving autonomous orchard vehicle trajectory tracking performance via slippage compensation

Improving autonomous orchard vehicle trajectory tracking performance via slippage compensation Improving autonomous orchard vehicle trajectory tracking performance via slippage compensation Dr. Gokhan BAYAR Mechanical Engineering Department of Bulent Ecevit University Zonguldak, Turkey This study

More information

Data Association for SLAM

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

More information

ON THE VELOCITY OF A WEIGHTED CYLINDER DOWN AN INCLINED PLANE

ON THE VELOCITY OF A WEIGHTED CYLINDER DOWN AN INCLINED PLANE ON THE VELOCITY OF A WEIGHTED CYLINDER DOWN AN INCLINED PLANE Raghav Grover and Aneesh Agarwal RG (Grade 12 High School), AA (Grade 11 High School) Department of Physics, The Doon School, Dehradun. raghav.503.2019@doonschool.com,

More information

TEST RESULTS OF A GPS/INERTIAL NAVIGATION SYSTEM USING A LOW COST MEMS IMU

TEST RESULTS OF A GPS/INERTIAL NAVIGATION SYSTEM USING A LOW COST MEMS IMU TEST RESULTS OF A GPS/INERTIAL NAVIGATION SYSTEM USING A LOW COST MEMS IMU Alison K. Brown, Ph.D.* NAVSYS Corporation, 1496 Woodcarver Road, Colorado Springs, CO 891 USA, e-mail: abrown@navsys.com Abstract

More information

IVR: Open- and Closed-Loop Control. M. Herrmann

IVR: Open- and Closed-Loop Control. M. Herrmann IVR: Open- and Closed-Loop Control M. Herrmann Overview Open-loop control Feed-forward control Towards feedback control Controlling the motor over time Process model V B = k 1 s + M k 2 R ds dt Stationary

More information

Evaluating the Performance of a Vehicle Pose Measurement System

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

More information

Spline-based Trajectory Optimization for Autonomous Vehicles with Ackerman drive

Spline-based Trajectory Optimization for Autonomous Vehicles with Ackerman drive Spline-based Trajectory Optimization for Autonomous Vehicles with Ackerman drive Martin Gloderer Andreas Hertle Department of Computer Science, University of Freiburg Abstract Autonomous vehicles with

More information

EE6102 Multivariable Control Systems

EE6102 Multivariable Control Systems EE612 Multivariable Control Systems Homework Assignments for Part 2 Prepared by Ben M. Chen Department of Electrical & Computer Engineering National University of Singapore April 21, 212 EE612 Multivariable

More information

Obstacle Avoidance Project: Final Report

Obstacle Avoidance Project: Final Report ERTS: Embedded & Real Time System Version: 0.0.1 Date: December 19, 2008 Purpose: A report on P545 project: Obstacle Avoidance. This document serves as report for P545 class project on obstacle avoidance

More information

Ground Plane Motion Parameter Estimation For Non Circular Paths

Ground Plane Motion Parameter Estimation For Non Circular Paths Ground Plane Motion Parameter Estimation For Non Circular Paths G.J.Ellwood Y.Zheng S.A.Billings Department of Automatic Control and Systems Engineering University of Sheffield, Sheffield, UK J.E.W.Mayhew

More information

Hybrid system design for platoon collaborative strategies

Hybrid system design for platoon collaborative strategies 4th International Conference on Sustainable Energy and Environmental Engineering (ICSEEE 205) Hybrid system design for platoon collaborative strategies HUANG Zichao,a, WU Qing,b, MA Jie2,c 2 School of

More information

Manipulator trajectory planning

Manipulator trajectory planning Manipulator trajectory planning Václav Hlaváč Czech Technical University in Prague Faculty of Electrical Engineering Department of Cybernetics Czech Republic http://cmp.felk.cvut.cz/~hlavac Courtesy to

More information

Tightly-Integrated Visual and Inertial Navigation for Pinpoint Landing on Rugged Terrains

Tightly-Integrated Visual and Inertial Navigation for Pinpoint Landing on Rugged Terrains Tightly-Integrated Visual and Inertial Navigation for Pinpoint Landing on Rugged Terrains PhD student: Jeff DELAUNE ONERA Director: Guy LE BESNERAIS ONERA Advisors: Jean-Loup FARGES Clément BOURDARIAS

More information

Modeling, Parameter Estimation, and Navigation of Indoor Quadrotor Robots

Modeling, Parameter Estimation, and Navigation of Indoor Quadrotor Robots Brigham Young University BYU ScholarsArchive All Theses and Dissertations 2013-04-29 Modeling, Parameter Estimation, and Navigation of Indoor Quadrotor Robots Stephen C. Quebe Brigham Young University

More information

Mobile Robot Kinematics

Mobile Robot Kinematics Mobile Robot Kinematics Dr. Kurtuluş Erinç Akdoğan kurtuluserinc@cankaya.edu.tr INTRODUCTION Kinematics is the most basic study of how mechanical systems behave required to design to control Manipulator

More information

Balancing Control of Two Wheeled Mobile Robot Based on Decoupling Controller

Balancing Control of Two Wheeled Mobile Robot Based on Decoupling Controller Ahmed J. Abougarair Elfituri S. Elahemer Balancing Control of Two Wheeled Mobile Robot Based on Decoupling Controller AHMED J. ABOUGARAIR Electrical and Electronics Engineering Dep University of Tripoli

More information

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

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

More information

Introduction to Autonomous Mobile Robots

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

More information

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

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

More information

CAMERA POSE ESTIMATION OF RGB-D SENSORS USING PARTICLE FILTERING

CAMERA POSE ESTIMATION OF RGB-D SENSORS USING PARTICLE FILTERING CAMERA POSE ESTIMATION OF RGB-D SENSORS USING PARTICLE FILTERING By Michael Lowney Senior Thesis in Electrical Engineering University of Illinois at Urbana-Champaign Advisor: Professor Minh Do May 2015

More information

Estimation of Unknown Disturbances in Gimbal Systems

Estimation of Unknown Disturbances in Gimbal Systems Estimation of Unknown Disturbances in Gimbal Systems Burak KÜRKÇÜ 1, a, Coşku KASNAKOĞLU 2, b 1 ASELSAN Inc., Ankara, Turkey 2 TOBB University of Economics and Technology, Ankara, Turkey a bkurkcu@aselsan.com.tr,

More information

UAV Autonomous Navigation in a GPS-limited Urban Environment

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

More information

Robust Pole Placement using Linear Quadratic Regulator Weight Selection Algorithm

Robust Pole Placement using Linear Quadratic Regulator Weight Selection Algorithm 329 Robust Pole Placement using Linear Quadratic Regulator Weight Selection Algorithm Vishwa Nath 1, R. Mitra 2 1,2 Department of Electronics and Communication Engineering, Indian Institute of Technology,

More information

Distributed Vision-Aided Cooperative Navigation Based on Three-View Geometry

Distributed Vision-Aided Cooperative Navigation Based on Three-View Geometry Distributed Vision-Aided Cooperative Navigation Based on hree-view Geometry Vadim Indelman, Pini Gurfil Distributed Space Systems Lab, Aerospace Engineering, echnion Ehud Rivlin Computer Science, echnion

More information

Control of Industrial and Mobile Robots

Control of Industrial and Mobile Robots Control of Industrial and Mobile Robots Prof. Rocco, Bascetta January 29, 2019 name: university ID number: signature: Warnings This file consists of 10 pages (including cover). During the exam you are

More information

1498. End-effector vibrations reduction in trajectory tracking for mobile manipulator

1498. End-effector vibrations reduction in trajectory tracking for mobile manipulator 1498. End-effector vibrations reduction in trajectory tracking for mobile manipulator G. Pajak University of Zielona Gora, Faculty of Mechanical Engineering, Zielona Góra, Poland E-mail: g.pajak@iizp.uz.zgora.pl

More information

Navigational Aids 1 st Semester/2007/TF 7:30 PM -9:00 PM

Navigational Aids 1 st Semester/2007/TF 7:30 PM -9:00 PM Glossary of Navigation Terms accelerometer. A device that senses inertial reaction to measure linear or angular acceleration. In its simplest form, it consists of a case-mounted spring and mass arrangement

More information

Construction, Modeling and Automatic Control of a UAV Helicopter

Construction, Modeling and Automatic Control of a UAV Helicopter Construction, Modeling and Automatic Control of a UAV Helicopter BEN M. CHENHEN EN M. C Department of Electrical and Computer Engineering National University of Singapore 1 Outline of This Presentation

More information

Vision-Based Control of a Multi-Rotor Helicopter

Vision-Based Control of a Multi-Rotor Helicopter Vision-Based Control of a Multi-Rotor Helicopter Justin Haines CMU-RI-TR-00-00 Submitted in partial fulfillment of the requirements for the degree of Master of Science in Robotics Robotics Institute Carnegie

More information

E80. Experimental Engineering. Lecture 9 Inertial Measurement

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

More information

YAW ANGLE CONTROL FOR AUTONOMOUS VEHICLE USING KALMAN FILTER BASED DISTURBANCE OBSERVER

YAW ANGLE CONTROL FOR AUTONOMOUS VEHICLE USING KALMAN FILTER BASED DISTURBANCE OBSERVER XXXX YAW ANGLE CONTROL FOR AUTONOMOUS VEHICLE USING KALMAN FILTER BASED DISTURBANCE OBSERVER Binh Minh Nguyen ) Hiroshi Fujimoto ) Yoichi Hori ) ) The University of Tokyo, Graduate School of Frontier Sciences,

More information

SUPPORTING LINEAR MOTION: A COMPLETE GUIDE TO IMPLEMENTING DYNAMIC LOAD SUPPORT FOR LINEAR MOTION SYSTEMS

SUPPORTING LINEAR MOTION: A COMPLETE GUIDE TO IMPLEMENTING DYNAMIC LOAD SUPPORT FOR LINEAR MOTION SYSTEMS SUPPORTING LINEAR MOTION: A COMPLETE GUIDE TO IMPLEMENTING DYNAMIC LOAD SUPPORT FOR LINEAR MOTION SYSTEMS Released by: Keith Knight Catalyst Motion Group Engineering Team Members info@catalystmotiongroup.com

More information

1 Introduction. Control 1:

1 Introduction. Control 1: 1 1 Introduction Hierarchical Control for Mobile Robots Motive Autonomy Control Level We build controllers because: Real hardware ultimately responds to forces, energy, power, etc. whereas we are concerned

More information

An Experimental Exploration of Low-Cost Solutions for Precision Ground Vehicle Navigation

An Experimental Exploration of Low-Cost Solutions for Precision Ground Vehicle Navigation An Experimental Exploration of Low-Cost Solutions for Precision Ground Vehicle Navigation Daniel Cody Salmon David M. Bevly Auburn University GPS and Vehicle Dynamics Laboratory 1 Introduction Motivation

More information

Evaluation of Moving Object Tracking Techniques for Video Surveillance Applications

Evaluation of Moving Object Tracking Techniques for Video Surveillance Applications International Journal of Current Engineering and Technology E-ISSN 2277 4106, P-ISSN 2347 5161 2015INPRESSCO, All Rights Reserved Available at http://inpressco.com/category/ijcet Research Article Evaluation

More information

Simulation. x i. x i+1. degrees of freedom equations of motion. Newtonian laws gravity. ground contact forces

Simulation. x i. x i+1. degrees of freedom equations of motion. Newtonian laws gravity. ground contact forces Dynamic Controllers Simulation x i Newtonian laws gravity ground contact forces x i+1. x degrees of freedom equations of motion Simulation + Control x i Newtonian laws gravity ground contact forces internal

More information

Challenge Problem 5 - The Solution Dynamic Characteristics of a Truss Structure

Challenge Problem 5 - The Solution Dynamic Characteristics of a Truss Structure Challenge Problem 5 - The Solution Dynamic Characteristics of a Truss Structure In the final year of his engineering degree course a student was introduced to finite element analysis and conducted an assessment

More information

CHAPTER 2 SENSOR DATA SIMULATION: A KINEMATIC APPROACH

CHAPTER 2 SENSOR DATA SIMULATION: A KINEMATIC APPROACH 27 CHAPTER 2 SENSOR DATA SIMULATION: A KINEMATIC APPROACH 2.1 INTRODUCTION The standard technique of generating sensor data for navigation is the dynamic approach. As revealed in the literature (John Blakelock

More information

Mobile robot control on uneven and slippery ground: an adaptive approach based on a multi-model observer

Mobile robot control on uneven and slippery ground: an adaptive approach based on a multi-model observer Author manuscript, published in "IEEE/RSJ International Conference on Intelligent Robots and Systems, IROS'12, Vilamoura : Portugal (2012)" Mobile robot control on uneven and slippery ground: an adaptive

More information

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

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

More information

Experimental study of a fast mobile robot performing a drift maneuver

Experimental study of a fast mobile robot performing a drift maneuver 1 Experimental study of a fast mobile robot performing a drift maneuver Eric Lucet,, Christophe Grand, Alexander V. Terekhov, and Philippe Bidaud *Institut des Systèmes Intelligents et de Robotique Université

More information

Introduction to Mobile Robotics Path Planning and Collision Avoidance. Wolfram Burgard, Maren Bennewitz, Diego Tipaldi, Luciano Spinello

Introduction to Mobile Robotics Path Planning and Collision Avoidance. Wolfram Burgard, Maren Bennewitz, Diego Tipaldi, Luciano Spinello Introduction to Mobile Robotics Path Planning and Collision Avoidance Wolfram Burgard, Maren Bennewitz, Diego Tipaldi, Luciano Spinello 1 Motion Planning Latombe (1991): is eminently necessary since, by

More information

Motion Capture & Simulation

Motion Capture & Simulation Motion Capture & Simulation Motion Capture Character Reconstructions Joint Angles Need 3 points to compute a rigid body coordinate frame 1 st point gives 3D translation, 2 nd point gives 2 angles, 3 rd

More information

CONTROL AND WAYPOINT NAVIGATION OF AN AUTONOMOUS GROUND VEHICLE

CONTROL AND WAYPOINT NAVIGATION OF AN AUTONOMOUS GROUND VEHICLE i CONTROL AND WAYPOINT NAVIGATION OF AN AUTONOMOUS GROUND VEHICLE A Thesis by JAMES PATRICK MASSEY Submitted to the Office of Graduate Studies of Texas A&M University in partial fulfillment of the requirements

More information

W4. Perception & Situation Awareness & Decision making

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

More information

COARSE LEVELING OF INS ATTITUDE UNDER DYNAMIC TRAJECTORY CONDITIONS. Paul G. Savage Strapdown Associates, Inc.

COARSE LEVELING OF INS ATTITUDE UNDER DYNAMIC TRAJECTORY CONDITIONS. Paul G. Savage Strapdown Associates, Inc. COARSE LEVELIG OF IS ATTITUDE UDER DYAMIC TRAJECTORY CODITIOS Paul G. Savage Strapdown Associates, Inc. SAI-W-147 www.strapdownassociates.com January 28, 215 ASTRACT Approximate attitude initialization

More information

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

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

More information

Outline Sensors. EE Sensors. H.I. Bozma. Electric Electronic Engineering Bogazici University. December 13, 2017

Outline Sensors. EE Sensors. H.I. Bozma. Electric Electronic Engineering Bogazici University. December 13, 2017 Electric Electronic Engineering Bogazici University December 13, 2017 Absolute position measurement Outline Motion Odometry Inertial systems Environmental Tactile Proximity Sensing Ground-Based RF Beacons

More information

Relating Local Vision Measurements to Global Navigation Satellite Systems Using Waypoint Based Maps

Relating Local Vision Measurements to Global Navigation Satellite Systems Using Waypoint Based Maps Relating Local Vision Measurements to Global Navigation Satellite Systems Using Waypoint Based Maps John W. Allen Samuel Gin College of Engineering GPS and Vehicle Dynamics Lab Auburn University Auburn,

More information

Bearing only visual servo control of a non-holonomic mobile robot. Robert Mahony

Bearing only visual servo control of a non-holonomic mobile robot. Robert Mahony Bearing only visual servo control of a non-holonomic mobile robot. Robert Mahony Department of Engineering, Australian National University, Australia. email: Robert.Mahony@anu.edu.au url: http://engnet.anu.edu.au/depeople/robert.mahony/

More information