A Model Predictive Control Approach for Combined Braking and Steering in Autonomous Vehicles

Size: px
Start display at page:

Download "A Model Predictive Control Approach for Combined Braking and Steering in Autonomous Vehicles"

Transcription

1 A Model Predictive Control Approach for Combined Braking and Steering in Autonomous Vehicles Paolo Falcone, Francesco Borrelli, Jahan Asgari, H. Eric Tseng, Davor Hrovat Università del Sannio, Dipartimento di Ingegneria, 8 Benevento, Italy {falcone,francesco.borrelli}@unisannio.it Ford Research Laboratories, Dearborn, MI 484, USA {jasgari,htseng,dhrovat}@ford.com Abstract In this paper we present a Model Predictive Control (MPC) approach for combined braking and steering systems in autonomous vehicles. We start from the result presented in [] and [], where a Model Predictive Controller (MPC) for autonomous steering systems has been presented. We formulate a predictive control problem in order to best follow a given path by controlling the front steering angle and the brakes at the four wheels independently, while fulfilling various physical and design constraints. I. INTRODUCTION Recent trends in automotive industry point in the direction of increased content of electronics, computers, and controls with emphasis on the improved functionality and overall system robustness. While this affects all of the vehicle areas, there is a particular interest in active safety. The available commercial active safety systems are mostly based on brake intervention. Anti-lock Braking Systems (ABS) and Electronic Stability Program (ESP) have been introduced to stabilize the longitudinal and yaw motion vehicle dynamics respectively. Future systems will be able to increase the effectiveness of active safety interventions by additional actuator types such as 4WS, active steering, active suspensions, or active differentials, and also by additional sensor information, such as the increased inclusion of onboard cameras, as well as infrared and other sensor alternatives. All these will be further complemented by GPS information including pre-stored mapping. In this context, it is possible to imagine that future vehicles would be able to identify obstacles on the road such as an animal, a rock, or fallen tree/branch, and assist the driver by following the best possible path, in terms of avoiding the obstacle and at the same time keeping the vehicle on the road at a safe distance from incoming traffic [], [3]. At this stage, we assume this ultimate obstacle avoidance system will be possible sometime in the future and we propose a double lane change scenario on a slippery road, with a vehicle equipped with fully autonomous steering and braking systems. The control input are the front steering angle and the braking at the four wheels and the goal is to follow the desired trajectory or target as close as possible while fulfilling various constraints reflecting vehicle physical limits. We assume a given desired trajectory and we will design a controller that can best follow the trajectory on slippery road at the highest possible entry speed. Anticipating sensor and infrastructure trends toward increased integration of information and control actuation agents, it is then appropriate to ask what is the best and optimum way in controlling the vehicle maneuver for given obstacle avoidance situation. This will be done in the spirit of Model Predictive Control, MPC [4], [5] along the lines of our ongoing internal research efforts dating from early [6]. We use a model of the plant to predict the future evolution of the system [5], [7], [8]. Based on this prediction, at each time step t a performance index is optimized under operating constraints with respect to a sequence of future steering and braking moves in order to best follow the given trajectory on a slippery road. The first of such optimal moves is the control action applied to the plant at time t. At time t +, a new optimization is solved over a shifted prediction horizon. In [] a nonlinear vehicle model is considered to predict the future evolution of the system [5]. The resulting MPC controller requires a non-linear optimization problem to be solved at each time step. Although good results have been achieved, even at high vehicle speed, the computational burden is a serious obstacle for experimental validation. In [] a sub-optimal MPC steering controller based on successive on-line linearizations of the nonlinear vehicle model is presented. The method stems from an accurate analysis of the vehicle nonlinearities, the constraints and the performance index in the optimal control problem. The presented experimental results demonstrated that the controller can stabilize the vehicle even at high speed on slippery surfaces. In this paper we reformulate the path following control problem in [] and [], as a MPC control problem where the control inputs are the front steering angle and the tire slip ratios at the four wheels. We assume that a lower level braking system is able to implement the desired tire slip ratios. The MPC formulation relies on a full four wheels nonlinear model including the tire nonlinearities. The paper is structured as follows. Section II describes the vehicle dynamical model used with a brief discussion on tire models. Section III formulates the control problem. The considered scenario is presented in Section IV. Sim-

2 ulation and experimental results are shown in section IV and concluding remarks in section V close the paper. II. MODELING This section describes the vehicle and tire model we used for simulations and control design. The nomenclature refers to the model depicted in Figure. We denote by F l, F c the longitudinal (or tractive ) and lateral (or cornering ) tire forces, respectively, F x, F y the longitudinal and lateral forces acting on the vehicle center of gravity, F z the normal tire load, X, Y the absolute car position inertial coordinates, a, b (distance of front and rear wheels from center of gravity) and c (distance of the vehicle longitudinal axis from the wheels) the car geometry, g the gravitational constant, m the car mass, I the car inertia, r the wheel radius, s the slip ratio, µ the road friction coefficient, v l, v c the longitudinal and lateral wheel velocities, ψ the heading angle, ẋ and ẏ the vehicle longitudinal and lateral speed respectively, α the slip angle, δ the wheel steering angle, µ the road friction coefficient and ψ the heading angle. The lower scripts ( ) f and ( ) r particularize a variable at the front wheels and the rear wheels, respectively, e.g. F lf is the front wheel longitudinal force. A. Vehicle Model We use a four wheels model to describe the dynamics of the car and assume constant normal tire load, i.e., F zf,l, F zf,r, F zr,l, F zr,r = constant. Such model captures the most relevant nonlinearities associated to lateral stabilization of the vehicle. Figure depicts a diagram of the vehicle model, which has the following longitudinal, lateral and turning or yaw degrees of freedom (DOF) mẍ = mẏ ψ + F xf,l + F xf,r + F xr,l + F xr,r mÿ = mẋ ψ + F yf,l + F yf,r + F yr,l + F yr,r, I ψ = a ( ) ( ) F yf,l + F yf,r b Fyr,l + F yr,r (a) (b) (c) + c ( F xf,l + F xf,r F xr,l + F xr,r ). (d) The vehicle s equations of motion in an absolute inertial frame are Ẏ = ẋ sin ψ + ẏ cos ψ, Ẋ = ẋ cos ψ ẏ sin ψ. (a) (b) The longitudinal and lateral forces generated by the four tires lead to the following forces acting on the center of gravity: F y = F l sin δ + F c cos δ, F x = F l cos δ F c sin δ. Tire forces for each tire are given by F l = f l (α, s, µ, F z ), F c = f c (α, s, µ, F z ), (3a) (3b) (4a) (4b) where α is the slip angle of the tire, s is the slip ratio defined as { s = rω s = v l if v l > rω, v for braking s = v l rω if v (5) l < rω, ω for driving where v l is the longitudinal wheel velocity, r and ω are the wheel radius and angular speed respectively. The slip angle represents the angle between the wheel velocity and the direction of the wheel itself: α = tan v c v l. (6) In equations (5) and (6), v c and v l are the lateral (or cornering) and longitudinal wheel velocities, respectively, which are expressed as and v l = v y sin δ + v x cos δ, v c = v y cos δ v x sin δ, (7a) (7b) v yf,l = ẏ + a ψ v xf,l = ẋ c ψ, (8a) v yf,r = ẏ + a ψ v xf,r = ẋ + c ψ, (8b) v yr,l = ẏ b ψ v xr,l = ẋ c ψ, (8c) v yr,r = ẏ b ψ v xr,r = ẋ + c ψ. (8d) The parameter µ in (4) represents the road friction coefficient and F z is the total vertical load of the vehicle. This is distributed between the front and rear wheels based on the geometry of the car model, described by the parameters a and b: F zf = bmg (a + b), F z r = amg (a + b). (9a) Using the equations ()-(9), the nonlinear vehicle dynamics can be described by the following compact differential equation assuming a certain friction coefficient value µ: Fig.. The simplified vehicle dynamical model. ξ = f µ (ξ, u), η = h(ξ), (a) (b)

3 where the state and input vectors are ξ = [ẏ, ẋ, ψ, ψ, Y, X] and u = [δ f, s f,l, s f,r, s r,l, s r,r ] respectively, and the output map is given as h(ξ) = ξ. () B. Tire Model The model for tire tractive and cornering forces (4) used in this paper is described by a Pacejka model [9]. This is a complex, semi-empirical model that takes into consideration the interaction between the tractive force and the cornering force in combined braking and steering. The longitudinal and cornering forces are assumed to depend on the normal force, slip angle, surface friction, and longitudinal slip. Sample plots of predicted longitudinal and lateral force versus longitudinal slip and slip angle are shown in Figure. These plots are shown for a single tire. l c l c Fig.. values. Tire forces as a function of longitudinal slip, with zero slip angle and µ = [.9,.7,.5,.3,.] 4 4 F l longitudinal force F c lateral force 3 3 Tire slip ratio [%] 4 4 Tire forces as a function of slip angle, with zero slip ratio and µ = [.9,.7,.5,.3,.] F l longitudinal force F c lateral force Tire slip angle [deg] Longitudinal and lateral tire forces with different µ coefficient III. MODEL PREDICTIVE CONTROL PROBLEM. We design a MPC controller computing the front steering angle and the slip ratios at the four wheels, such that a desired path is followed, while keeping the longitudinal speed as close as possible to a given reference. We assume the existence of a low level braking slip controller for each wheel and neglect their dynamics. In order to obtain a finite dimensional optimal control problem we consider the model () and discretize the system dynamics with the Euler method, to obtain ξ(k + ) = fµ dt (ξ(k), u(k)), (a) η(k) = h(ξ(k)), (b) where the u formulation is used, i.e., u(k) = u(k ) + u(k) and u(k) = [δ f (k), s f,l, s f,r, s r,l, s r,r ], u(k) = [ δ f (k), s f,l, s f,r, s r,l, s r,r ]. We consider the following cost function: H p J(ξ(t), U t ) = ˆη t+i,t η ref t+i,t + i= H c i= H c u t+i,t R + u t+i,t S + ρɛ i= Q (3) where, as in standard MPC notation [5], U t = u t,t,..., u t+hc,t is the optimization vector at time t and ˆη t+i,t denotes the output vector predicted at time t+ i obtained by starting from the state ξ t,t = ξ(t) and applying to system () the input sequence u t,t,..., u t+i,t. H p and H c denote the output prediction horizon and the control horizon, respectively. As in standard MPC schemes, we use H p > H c and the control signal is assumed constant for all H c t H p, i.e., u t+i,t = i H c. The reference signal η ref represents the desired outputs, where η = [ẋ, ψ, ψ, Y ]. Q, R and S are weighting matrices of appropriate dimensions. In (3) the first summand reflects the desired performance on target tracking, the second and the third summands are a measure of the steering and braking effort. The minimization of (3) subject to the model equation () is the base of the NLMPC scheme presented in [], where a steering only controller is designed. The LTV-MPC scheme presented in [], [] is used next. It is based on the following optimization problem: min U t J(ξ t, U t ) (4a) subj. to ξ k+,t = A t ξ k,t + B t u k,t + d k,t, α k,t = C t ξ k,t + D t u k,t + e k,t η k,t = ξ k,t k = t,..., t + H p u k,t = u k,t + u k,t, u t,t = u(t ) u f,min u k,t u f,max u f,min u k,t u f,max k = t,..., t + H c u k,t =, (4b) (4c) (4d) (4e) (4f) (4g) (4h) k = t + H c,..., t + H p (4i) α fmin ɛ α fk,t α fmax + ɛ (4j) α rmin ɛ α rk,t α rmax + ɛ (4k) ɛ ξ t,t = ξ(t) k = t,..., t + H p (4l) (4m) where the equations (4b) are a discrete linear approximation of () computed at the current state ξ(t) and the previously applied control input u(t ). In (4b)-(4c), the terms d k,t and e k,t take into account that the operating point ξ(t), u(t) in general is not an equilibrium point.

4 Y [m] Desired path Cone X [m] Fig. 3. The reference path to be followed Further details can be found in []. The optimization problem (4) can be recast as a quadratic program (QP) (details can be found in []) and the resulting MPC controller for a Linear Time Varying (LTV) system will solve the problem (4) at each time step. Once a solution U t to problem (4) has been obtained, the input command is computed as u(k) = u(k ) + u t,t, (5) where u t,t is the vector of the first m elements of U t if system (4b) has m inputs. At the next time step, the linear model (4b)-(4c) is computed based on new state and input measurements, and the new QP problem (4) is solved over a shifted horizon. Complexity of (4) reduces compared to the NLMPC in ref. [], and it is function of the time needed to setup the problem (4), i.e., to compute the linear models (A t, B t, C t, D t ) in (4b)-(4c) along the trajectory, and of the time to solve it. As in [], the stability of the closed loop system is enforced through the ad hoc constraints (4j), (4k). In particular, without the constraints (4j), (4k) the performance of the linear MPC controller (4)-(5) is not acceptable and sometime unstable. The motivations of constraints (4j), (4k) are further discussed in [], []. IV. SIMULATION RESULTS. In the considered scenario, the control objective is to follow the path shown in Figure 3 as close as possible on a snow covered road (µ =.3), while minimizing the deviation from the desired longitudinal speed (η ref () = ẋ ref in (3)). The control inputs are the front tire steering angle and the slip ratios at the four wheels. Two tunings will be considered. In the first tuning the longitudinal speed ẋ in not weighted and the objective is to show that the car slows down and it follows perfectly the desired path. In the second tuning a weight on the longitudinal speed is used and the objective is to show that the controller (4)-(5) performs better than a controller without brake intervention, i.e. steering only controller. The following parameters have been used for both tunings: sample time: T =.5 sec; constraints on inputs and input rates: δ f,min =- deg, δ f,max = deg, δ f,min =-.85 deg, δ f,max =.85 deg. The upper and lower bounds on the four slip ratios are % and.7% respectively (i.e. the vehicle can brake only), the upper and lower bounds on the braking rate are % and % respectively. constraints on the tire slip angles: α fmin = 3 deg, α fmax = 3 deg, α rmin = 3 deg, α rmax = 3 deg. Figures 4-6 report the simulation results of the controller (4)-(5) with ẋ ref = m/s and the first tuning, consisting in the following parameters: weights on tracking errors: Qẋ =, Q ψ =, Q ψ =, Q Y =, Q ij = for i j; weights on input rates: R δf = 5, R sf,l = 5, R sf,r = 5, R sr,l = 5, R sr,r = 5, R ij = for i j; weights on input: S i,j =, for i = j, S i,j =, for i j; horizons: H p = 5, H c = 5. We remark that the considered tuning does not penalize the deviation from the desired longitudinal speed as well as the braking intervention. On the other hand, high weights are used for the yaw, yaw rate and lateral position tracking errors. Moreover the length of the prediction horizon has been selected in order to allow the controller to significantly decrease the longitudinal speed before the first lane change. For lack of space we do not report the longitudinal speed during the manoeuvre. The longitudinal speed at the end of the double lane change is 3.5 m/s. As shown in Figure 4 the yaw, yaw rate and lateral position references are tracked perfectly, since the vehicle slows down drastically during the double lane change. It is interesting to observe that, before the first lane change, at both the front and rear axles, the braking interventions at the left and the right wheels are identical. This slows the car down as quick as possible without generating an undesired yaw moment in the first straight part of the manoeuvre. We also observe that from 3 s to 5 s the braking intervention at the rear wheels does not generate any yaw moment, the braking at the front right wheel is almost zero, while the braking at the front left wheel is at its maximum value. The resulting yaw moment is positive (counterclockwise). This behavior is coherent with the steering action aiming at generating a positive yaw moment. Between 5 and 8 s the braking at the rear wheels does not generate yaw moment, although the slip at both the left and right wheels is at the maximum value and the longitudinal speed decreases. Within the same time interval the slip at the front left wheel is zero, while the braking at the right wheel is generating a negative (clockwise) yaw moment. We conclude that the controller decreases the longitudinal speed by braking at the rear axes and it generates a yaw moment by braking the front wheels.

5 Ψ [deg] s f,l [%].5.5 s f,r [%].5.5 dψ/dt [deg/s] Y [m] Fig. 4. Combined braking and steering MPC controller with small weight on the longitudinal velocity error. Yaw angle ψ (upper plot), yaw rate ψ (middle plot), lateral position Y (lower plot) s r,l [%] s r,r [%] Fig. 6. Combined braking and steering MPC controller with small weight on the longitudinal velocity error. Slip ratios at the four wheels. δ f [deg] Ψ [deg] dψ/dt [deg/s] Fig. 5. Combined braking and steering MPC controller with small weight on the longitudinal velocity error. Steering angle Y [m] The second tuning will be considered next and compared to an MPC controller using steering only (Controller B). The MPC (4)-(5) is tuned in order to achieve a low deviation from the desired longitudinal speed in following the desired path (Controller A). In Figures 7-9 the simulation results of the Controller A are presented. The following tuning parameters have been used: weights on tracking errors: Qẋ = 5 4, Q ψ =, Q ψ =, Q Y =, Q ij = for i j; weights on input rates: R δf = 5 3, R sf,l = 3, R sf,r = 3, R sr,l = 3, R sr,r = 3, R ij = for i j; weights on input: S δf = 7, R sf,l = 5, R sf,r = 5, R sr,l = 5, R sr,r = 5, R ij = for i j; horizons: H p = 5, H c =. The longitudinal speed at the end of the manoeuvre is 6 m/s. In Figures - the simulation results of the Controller B at a longitudinal entry speed of m/s are shown. The controller has been derived from the MPC formulation presented in Section III by setting η = [ψ, ψ, Y ], u(k) = δ f (k) and u(k) = δ f (k), S = in (3). The following tuning parameters have been used: Fig. 7. Controller A. Yaw angle ψ (upper plot), yaw rate ψ (middle plot), lateral position Y (lower plot) weights on tracking errors: Q ψ = 3, Q ψ =, Q Y =, Q ij = for i j; weights on input rates: R δf = 5 3 ; horizons: H p = 5, H c =. The longitudinal speed at the end of the manoeuvre is.6 m/s. By comparing the results in Figures and 7 and the Root Mean Squared tracking errors reported in Table I, we observe that Controller A performs better than Controller B. In particular the RMS tracking error on the lateral position (ē Y in Table I) for Controller A is less than 5% of the same error for Controller B. We remark that the final longitudinal speed for the Controller A is lower that the Controller B. ē Ψ ē Ψ ē Y Controller A Controller B TABLE I RMS TRACKING ERROR FOR CONTROLLERS A AND B

6 3 Ψ [deg] δ f [deg] dψ/dt [deg/s] Y [m] Fig. 8. Controller A. Steering angle Fig.. Controller B. Yaw angle ψ (upper plot), yaw rate ψ (middle plot), lateral position Y (lower plot) s f,l [%].5 s f,r [%] δ f [deg].5.5 s r,l [%] s r,r [%] Fig.. Controller B. Steering angle. Fig. 9. Controller A. Slip ratios at the four wheels. V. CONCLUSIONS. We presented a Model Predictive Control for combined braking and steering in autonomous vehicles. The performance of the presented approach has been evaluated in simulations with a double lane change manoeuvre on a snow covered road at high speed. Performance enhancement is observed when combined braking and steering are used instead of steering only. Moreover the capability of the controller of slowing down the vehicle in order to perfectly follow the desired path has been shown. This will enable the use of hard constraints for obstacle avoidance strategies. REFERENCES [] F. Borrelli, P. Falcone, T. Keviczky, J. Asgari, and D. Hrovat, MPC-based approach to active steering for autonomous vehicle systems, Int. J. Vehicle Autonomous Systems, vol. 3, no. /3/4, pp. 65 9, 5. [] P. Falcone, F. Borrelli, J. Asgari, H. E. Tseng, and D. Hrovat, Predictive active steering control for autonomous vehicle systems, Accepted for publication in IEEE Trans. on Control System Technology, 6. [3] Y. Fujiwara, Y. Shoda, and S. Adachi, Development of obstacle avoidance system using co-operative control, in 6 th IFAC World Congress, Prague, Czech Republic, 5. [4] C. Garcia, D. Prett, and M. Morari, Model predictive control: Theory and practice-a survey, Automatica, vol. 5, pp , 989. [5] D. Mayne, J. Rawlings, C. Rao, and P. Scokaert, Constrained model predictive control: Stability and optimality, Automatica, vol. 36, no. 6, pp , June. [6] J. Asgari and D. Hrovat, Potential benefits of Interactive Vehicle Control Systems. Ford Motor Company, Dearborn (USA). Internal Report,. [7] F. Borrelli, Discrete time constrained optimal control, Ph.D. dissertation, Automatic Control Labotatory - ETH, Zurich,. [Online]. Available: [8] T. Keviczky, P. Falcone, F. Borrelli, J. Asgari, and D. Hrovat, Predictive control approach to autonomous vehicle steering, in Proc. American Contr. Conf., Minneapolis, Minnesota, 6. [9] E. Bakker, L. Nyborg, and H. B. Pacejka, Tyre modeling for use in vehicle dynamics studies, SAE paper # 874, 987. [] P. Falcone, F. Borrelli, J. Asgari, H. E. Tseng, and D. Hrovat, Linear time varying model predictive control and its application to active steering systems: Stability analisys and experimental validation, Technical Report TR44, Universitá del Sannio (available at 6. [], Predictive active steering control for autonomous vehicle systems, Universitá del Sannio. Dipartimento di Ingegneria., Tech. Rep., Jan. 7,

Low Complexity MPC Schemes for Integrated Vehicle Dynamics Control Problems

Low Complexity MPC Schemes for Integrated Vehicle Dynamics Control Problems AVEC 8 Low Complexity MPC Schemes for Integrated Vehicle Dynamics Control Problems Paolo Falcone, a Francesco Borrelli, b H. Eric Tseng, Jahan Asgari, Davor Hrovat c a Department of Signals and Systems,

More information

Predictive Active Steering Control for Autonomous Vehicle Systems

Predictive Active Steering Control for Autonomous Vehicle Systems IEEE TRANSACTION OF CONTROL SYSTEMS TECHNOLOGY, VOL., NO., JANUARY 7 1 Predictive Active Steering Control for Autonomous Vehicle Systems P. Falcone, F. Borrelli, J. Asgari, H. E. Tseng, D. Hrovat Abstract

More information

PREDICTIVE CONTROL OF AUTONOMOUS GROUND VEHICLES WITH OBSTACLE AVOIDANCE ON SLIPPERY ROADS

PREDICTIVE CONTROL OF AUTONOMOUS GROUND VEHICLES WITH OBSTACLE AVOIDANCE ON SLIPPERY ROADS PREDICTIVE CONTROL OF AUTONOMOUS GROUND VEHICLES WITH OBSTACLE AVOIDANCE ON SLIPPERY ROADS Yiqi Gao Theresa Lin Francesco Borrelli Department of Mechanical Engineering University of California Berkeley,

More information

Model Predictive Control for Autonomous and Semiautonomous Vehicles. Yiqi Gao

Model Predictive Control for Autonomous and Semiautonomous Vehicles. Yiqi Gao Model Predictive Control for Autonomous and Semiautonomous Vehicles by Yiqi Gao A dissertation submitted in partial satisfaction of the requirements for the degree of Doctor of Philosophy in Engineering

More information

Robust Vehicle Stability Control with an Uncertain Driver Model

Robust Vehicle Stability Control with an Uncertain Driver Model 23 European Control Conference (ECC) July 7-9, 23, Zürich, Switzerland. Robust Vehicle Stability Control with an Uncertain Driver Model Ashwin Carvalho, Giovanni Palmieri*, H. Eric Tseng, Luigi Glielmo*,

More information

Spatial Predictive Control for Agile Semi-Autonomous Ground Vehicles

Spatial Predictive Control for Agile Semi-Autonomous Ground Vehicles Spatial Predictive Control for Agile Semi-Autonomous Ground Vehicles Yiqi Gao*, Andrew Gray*, Janick V. Frasch, Theresa Lin*, Eric Tseng, J. Karl Hedrick*, Francesco Borrelli* *Department of Mechanical

More information

Robust Nonlinear Predictive Control for Semiautonomous Ground Vehicles

Robust Nonlinear Predictive Control for Semiautonomous Ground Vehicles 14 American Control Conference (ACC) June 4-6, 14. Portland, Oregon, USA Robust Nonlinear Predictive Control for Semiautonomous Ground Vehicles Yiqi Gao, Andrew Gray, Ashwin Carvalho, H. Eric Tseng, Francesco

More information

Semi-Autonomous Vehicle Control for Road Departure and Obstacle Avoidance

Semi-Autonomous Vehicle Control for Road Departure and Obstacle Avoidance Semi-Autonomous Vehicle Control for Road Departure and Obstacle Avoidance Andrew Gray Mohammad Ali, Yiqi Gao J. Karl Hedrick Francesco Borrelli Mechanical Engineering, University of California, Berkeley,

More information

Robust Model Predictive Control for Autonomous Vehicle/Self-Driving Cars

Robust Model Predictive Control for Autonomous Vehicle/Self-Driving Cars Robust Model Predictive Control for Autonomous Vehicle/Self-Driving Cars Che Kun Law, Darshit Dalal, Stephen Shearrow A robust Model Predictive Control (MPC) approach for controlling front steering of

More information

Single-track models of an A-double heavy vehicle combination

Single-track models of an A-double heavy vehicle combination Single-track models of an A-double heavy vehicle combination PETER NILSSON KRISTOFFER TAGESSON Department of Applied Mechanics Division of Vehicle Engineering and Autonomous Systems Vehicle Dynamics Group

More information

Torque Based Lane Change Assistance with Active Front Steering

Torque Based Lane Change Assistance with Active Front Steering Torque Based Lane Change Assistance with Active Front Steering Monimoy Bujarbaruah, Ziya Ercan, Vladimir Ivanovic, H. Eric Tseng, Francesco Borrelli Authors contributed equally. University of California

More information

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

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

More information

Analysis and Control of Nonlinear Actuator Dynamics Based on the Sum of Squares Programming Method

Analysis and Control of Nonlinear Actuator Dynamics Based on the Sum of Squares Programming Method Analysis and Control of Nonlinear Actuator Dynamics Based on the Sum of Squares Programming Method Balázs Németh and Péter Gáspár Abstract The paper analyses the reachability characteristics of the brake

More information

LTV-MPC Approach for Lateral Vehicle Guidance by Front Steering at the Limits of Vehicle Dynamics

LTV-MPC Approach for Lateral Vehicle Guidance by Front Steering at the Limits of Vehicle Dynamics 2011 50th IEEE Conference on Decision and Control and European Control Conference (CDC-ECC) Orlando, FL, USA, December 12-15, 2011 LTV-MPC Approach for Lateral Vehicle Guidance by Front Steering at the

More information

A Robust Lateral Vehicle Dynamics Control

A Robust Lateral Vehicle Dynamics Control AVEC 1 A Robust Lateral Vehicle Dynamics Control Giovanni Palmieri*, Miroslav Barić, Francesco Borrelli, Luigi Glielmo* *Engineering Department, Università degli Studi del Sannio, 821, Italy Department

More information

Estimation of Tire-Road Friction by Tire Rotational Vibration Model

Estimation of Tire-Road Friction by Tire Rotational Vibration Model 53 Research Report Estimation of Tire-Road Friction by Tire Rotational Vibration Model Takaji Umeno Abstract Tire-road friction is the most important piece of information used by active safety systems.

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

Yaw-rate Control for Electric Vehicle with Active Front/Rear Steering and Driving/Braking Force Distribution of Rear Wheels

Yaw-rate Control for Electric Vehicle with Active Front/Rear Steering and Driving/Braking Force Distribution of Rear Wheels The th IEEE International Workshop on Advanced Motion Control March -4,, Nagaoka, Japan Yaw-rate Control for Electric Vehicle with Active Front/Rear Steering and Driving/Braking Force Distribution of Rear

More information

Hierarchical steering control for a front wheel drive automated car

Hierarchical steering control for a front wheel drive automated car Hierarchical steering control for a front wheel drive automated car Sándor Beregi, Dénes Takács, Chaozhe R. He, Sergei S. Avedisov, Gábor Orosz Department of Applied Mechanics, Budapest University of Technology

More information

Predictive vehicle motion control for post-crash scenarios

Predictive vehicle motion control for post-crash scenarios DEGREE PROJECT IN ELECTRICAL ENGINEERING, SECOND CYCLE, 30 CREDITS STOCKHOLM, SWEDEN 2017 Predictive vehicle motion control for post-crash scenarios DÁVID NIGICSER KTH ROYAL INSTITUTE OF TECHNOLOGY SCHOOL

More information

Research Article Application of Recursive Least Square Algorithm on Estimation of Vehicle Sideslip Angle and Road Friction

Research Article Application of Recursive Least Square Algorithm on Estimation of Vehicle Sideslip Angle and Road Friction Mathematical Problems in Engineering Volume 21, Article ID 54189, 18 pages doi:1.1155/21/54189 Research Article Application of Recursive Least Square Algorithm on Estimation of Vehicle Sideslip Angle and

More information

ACTIVE DIRECT TILT CONTROL FOR STABILITY ENHANCEMENT OF A NARROW COMMUTER VEHICLE

ACTIVE DIRECT TILT CONTROL FOR STABILITY ENHANCEMENT OF A NARROW COMMUTER VEHICLE International Journal of Automotive Technology, Vol. 5, No. 2, pp. 77 88 (24) Copyright 24 KSAE 1229 9138/24/16 2 ACTIVE DIRECT TILT CONTROL FOR STABILITY ENHANCEMENT OF A NARROW COMMUTER VEHICLE D. PIYABONGKARN,

More information

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

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

More information

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

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

More information

Improving EV Lateral Dynamics Control Using Infinity Norm Approach with Closed-form Solution

Improving EV Lateral Dynamics Control Using Infinity Norm Approach with Closed-form Solution Improving EV Lateral Dynamics Control Using Infinity Norm Approach with Closed-form Solution Alexander Viehweider Dept. of Advanced Energy The University of Tokyo, 5-1-5 Kashiwanoha, Kashiwa, Chiba, Japan

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

Optimal Control for Race Car Minimum Time Maneuvering

Optimal Control for Race Car Minimum Time Maneuvering Optimal Control for Race Car Minimum Time Maneuvering Master of Science Thesis Delft Center for Systems and Control Optimal Control for Race Car Minimum Time Maneuvering Master of Science Thesis For the

More information

1 INTRODUCTION 2 PROBLEM DEFINITION

1 INTRODUCTION 2 PROBLEM DEFINITION Autonomous cruise control with cut-in target vehicle detection Ashwin Carvalho, Alek Williams, Stéphanie Lefèvre & Francesco Borrelli Department of Mechanical Engineering University of California Berkeley,

More information

Stochastic Predictive Control for Semi-Autonomous Vehicles with an Uncertain Driver Model

Stochastic Predictive Control for Semi-Autonomous Vehicles with an Uncertain Driver Model Proceedings of the 16th International IEEE Annual Conference on Intelligent Transportation Systems (ITSC 213), The Hague, The Netherlands, October 6-9, 213 WeC62 Stochastic Predictive Control for Semi-Autonomous

More information

Model-Based Threat Assessment in Semi-Autonomous Vehicles with Model Parameter Uncertainties

Model-Based Threat Assessment in Semi-Autonomous Vehicles with Model Parameter Uncertainties Model-Based Threat Assessment in Semi-Autonomous Vehicles with Model Parameter Uncertainties Mohammad Ali, Paolo Falcone and Jonas Sjöberg Abstract In this paper, we consider model-based threat assessment

More information

arxiv: v2 [cs.sy] 23 Jun 2017

arxiv: v2 [cs.sy] 23 Jun 2017 A Simple Dynamic Model for Aggressive, Near-Limits Trajectory Planning Florent Altché,1, Philip Polack 1 and Arnaud de La Fortelle 1 arxiv:173.1v [cs.sy] 3 Jun 17 Abstract In normal on-road situations,

More information

Jurnal Teknologi IMPLEMENTATION OF ROBUST COMPOSITE NONLINEAR FEEDBACK FOR ACTIVE FRONT STEERING BASED VEHICLE YAW STABILITY.

Jurnal Teknologi IMPLEMENTATION OF ROBUST COMPOSITE NONLINEAR FEEDBACK FOR ACTIVE FRONT STEERING BASED VEHICLE YAW STABILITY. Jurnal Teknologi IMPLEMENTATION OF ROBUST COMPOSITE NONLINEAR FEEDBACK FOR ACTIVE FRONT STEERING BASED VEHICLE YAW STABILITY Mohd Hanif Che Hasan a*, Yahaya Md Sam b, Muhamad Khairi Aripin c, Mohamad Haniff

More information

Postprint. This is the accepted version of a paper presented at IEEE Conference on Decision and Control.

Postprint.   This is the accepted version of a paper presented at IEEE Conference on Decision and Control. http://www.diva-portal.org Postprint This is the accepted version of a paper presented at IEEE Conference on Decision and Control. Citation for the original published paper: Lima, P F., Mårtensson, J.,

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

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

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

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

More information

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

Learning Model Predictive Control for Iterative Tasks: A Computationally Efficient Approach for Linear System

Learning Model Predictive Control for Iterative Tasks: A Computationally Efficient Approach for Linear System Learning Model Predictive Control for Iterative Tasks: A Computationally Efficient Approach for Linear System Ugo Rosolia Francesco Borrelli University of California at Berkeley, Berkeley, CA 94701, USA

More information

Prediction and Prevention of Tripped Rollovers

Prediction and Prevention of Tripped Rollovers Prediction and Prevention of Tripped Rollovers Final Report Prepared by: Gridsada Phanomchoeng Rajesh Rajamani Department of Mechanical Engineering University of Minnesota CTS 12-33 Technical Report Documentation

More information

Handling Roll Constraints for Path Following of Marine Surface Vessels using Coordinated Rudder and Propulsion Control

Handling Roll Constraints for Path Following of Marine Surface Vessels using Coordinated Rudder and Propulsion Control 2010 American Control Conference Marriott Waterfront, Baltimore, MD, USA June 30-July 02, 2010 FrB15.5 Handling Roll Constraints for Path Following of Marine Surface Vessels using Coordinated Rudder and

More information

NONLINEAR BACKSTEPPING DESIGN OF ANTI-LOCK BRAKING SYSTEMS WITH ASSISTANCE OF ACTIVE SUSPENSIONS

NONLINEAR BACKSTEPPING DESIGN OF ANTI-LOCK BRAKING SYSTEMS WITH ASSISTANCE OF ACTIVE SUSPENSIONS NONLINEA BACKSTEPPING DESIGN OF ANTI-LOCK BAKING SYSTEMS WITH ASSISTANCE OF ACTIVE SUSPENSIONS Wei-En Ting and Jung-Shan Lin 1 Department of Electrical Engineering National Chi Nan University 31 University

More information

Lecture Notes Multibody Dynamics B, wb1413

Lecture Notes Multibody Dynamics B, wb1413 Lecture Notes Multibody Dynamics B, wb1413 A. L. Schwab & Guido M.J. Delhaes Laboratory for Engineering Mechanics Mechanical Engineering Delft University of Technolgy The Netherlands June 9, 29 Contents

More information

2nd International Conference on Electronic & Mechanical Engineering and Information Technology (EMEIT-2012)

2nd International Conference on Electronic & Mechanical Engineering and Information Technology (EMEIT-2012) Estimation of Vehicle State and Road Coefficient for Electric Vehicle through Extended Kalman Filter and RS Approaches IN Cheng 1, WANG Gang 1, a, CAO Wan-ke 1 and ZHOU Feng-jun 1, b 1 The National Engineering

More information

Road Vehicle Dynamics

Road Vehicle Dynamics Road Vehicle Dynamics Table of Contents: Foreword Preface Chapter 1 Introduction 1.1 General 1.2 Vehicle System Classification 1.3 Dynamic System 1.4 Classification of Dynamic System Models 1.5 Constraints,

More information

Jackknife stability of a tractor semi-trailer combination

Jackknife stability of a tractor semi-trailer combination TU/e Mechanical Engineering Masterproject 2006-2007 Jackknife stability of a tractor semi-trailer combination Author: J.W.L.H. Maas (0529865) Tutor: Prof. dr. H. Nijmeijer Eindhoven, 11 June 2007 Abstract

More information

Robust Predictive Control for Semi-Autonomous Vehicles with an Uncertain Driver Model

Robust Predictive Control for Semi-Autonomous Vehicles with an Uncertain Driver Model 213 IEEE Intelligent Vehicles Symposium (IV) June 23-26, 213, Gold Coast, Australia Robust Predictive Control for Semi-Autonomous Vehicles with an Uncertain Driver Model Andrew Gray, Yiqi Gao, J. Karl

More information

A Unified Framework for Trajectory Planning, Threat Assessment, and Semi-Autonomous Control of Passenger Vehicles

A Unified Framework for Trajectory Planning, Threat Assessment, and Semi-Autonomous Control of Passenger Vehicles A Unified Framework for Trajectory Planning, Threat Assessment, and Semi-Autonomous Control of Passenger Vehicles by Sterling J Anderson Bachelor of Science in Mechanical Engineering Brigham Young University

More information

Vehicle Parameter Identification and its Use in Control for Safe Path Following. Sanghyun Hong

Vehicle Parameter Identification and its Use in Control for Safe Path Following. Sanghyun Hong Vehicle Parameter Identification and its Use in Control for Safe Path Following by Sanghyun Hong A dissertation submitted in partial satisfaction of the requirements for the degree of Doctor of Philosophy

More information

A SELF-TUNING ABS CONTROL FOR ELECTROMECHANICAL BRAKING SYSTEMS

A SELF-TUNING ABS CONTROL FOR ELECTROMECHANICAL BRAKING SYSTEMS A SELF-TUNING ABS CONTROL FOR ELECTROMECHANICAL BRAKING SYSTEMS Riccardo Morselli Roberto Zanasi DII, University of Modena and Reggio Emilia Via Vignolese 905, 41100 Modena, Italy Phone: +39 59 2056161,

More information

Simulation of an articulated tractor-implement-trailer model under the influence of lateral disturbances

Simulation of an articulated tractor-implement-trailer model under the influence of lateral disturbances Simulation of an articulated tractor-implement-trailer model under the influence of lateral disturbances K. W. Siew, J. Katupitiya and R. Eaton and H.Pota Abstract This paper presents the derivation of

More information

DYNAMIC MODELLING AND IDENTIFICATION OF A CAR. Gentiane Venture* Wisama Khalil** Maxime Gautier** Philippe Bodson*

DYNAMIC MODELLING AND IDENTIFICATION OF A CAR. Gentiane Venture* Wisama Khalil** Maxime Gautier** Philippe Bodson* DYNAMIC MODELLING AND IDENTIFICATION OF A CAR Gentiane Venture* Wisama Khalil** Maxime Gautier** Philippe Bodson* *P.S.A. Peugeot Citroën Direction Plates-formes, Techniques et Achats Route de Gisy 78943

More information

The single track model

The single track model The single track model Dr. M. Gerdts Uniersität Bayreuth, SS 2003 Contents 1 Single track model 1 1.1 Geometry.................................... 1 1.2 Computation of slip angles...........................

More information

FEEDFORWARD COMPENSATION FOR LATERAL CONTROL OF HEAVY VEHICLES FOR AUTOMATED HIGHWAY SYSTEM (AHS)

FEEDFORWARD COMPENSATION FOR LATERAL CONTROL OF HEAVY VEHICLES FOR AUTOMATED HIGHWAY SYSTEM (AHS) Copyright IFAC 5th Triennial World Congress, Barcelona, Spain FEEDFORWARD COMPENSATION FOR LATERAL CONTROL OF HEAVY VEHICLES FOR AUTOMATED HIGHWAY SYSTEM (AHS) Meihua Tai, Masayoshi Tomizuka Department

More information

Time-Optimal Automobile Test Drives with Gear Shifts

Time-Optimal Automobile Test Drives with Gear Shifts Time-Optimal Control of Automobile Test Drives with Gear Shifts Christian Kirches Interdisciplinary Center for Scientific Computing (IWR) Ruprecht-Karls-University of Heidelberg, Germany joint work with

More information

Electric Vehicle Lateral Dynamics Control based on Instantaneous Cornering Stiffness Estimation and an Efficient Allocation Scheme

Electric Vehicle Lateral Dynamics Control based on Instantaneous Cornering Stiffness Estimation and an Efficient Allocation Scheme Electric Vehicle Lateral Dynamics Control based on Instantaneous Cornering Stiffness Estimation and an Efficient Allocation Scheme A. Viehweider Y. Hori The University of Tokyo, Department of Advanced

More information

A study on wheel force measurement using strain gauge equipped wheels

A study on wheel force measurement using strain gauge equipped wheels A study on wheel force measurement using strain gauge equipped wheels PAVLOS MAVROMATIDIS a, ANDREAS KANARACHOS b Electrical Engineering Department a, Mechanical Engineering Department b Frederick University

More information

Investigation of Steering Feedback Control Strategies for Steer-by-Wire Concept

Investigation of Steering Feedback Control Strategies for Steer-by-Wire Concept Master of Science Thesis in Electrical Engineering Department of Electrical Engineering, Linköping University, 2018 Investigation of Steering Feedback Control Strategies for Steer-by-Wire Concept Martin

More information

Estimation of Contact Forces and Road Profile using High Order Sliding Modes. A. Rabhi 1, N. K. M Sirdi 2, A. Naamane 2 and B.

Estimation of Contact Forces and Road Profile using High Order Sliding Modes. A. Rabhi 1, N. K. M Sirdi 2, A. Naamane 2 and B. Int J Accounting, Auditing and Performance Evaluation, Vol x, No x, xxxx 1 Estimation of Contact Forces and Road Profile using High Order Sliding Modes A Rabhi 1, N K M Sirdi 2, A Naamane 2 and B Jaballah

More information

Lateral Path-Following Control for Automated Vehicle Platoons

Lateral Path-Following Control for Automated Vehicle Platoons Lateral Path-Following Control for Automated Vehicle Platoons Master of Science Thesis Delft Center for Systems and Control Lateral Path-Following Control for Automated Vehicle Platoons Master of Science

More information

COMBINING LANEKEEPING AND VEHICLE FOLLOWING WITH HAZARD MAPS

COMBINING LANEKEEPING AND VEHICLE FOLLOWING WITH HAZARD MAPS COMBINING LANEKEEPING AND VEHICLE FOLLOWING WITH HAZARD MAPS J. Christian Gerdes, Stanford University, Stanford, CA Ursina Saur, ETH, Zurich Eric J. Rossetter, Stanford University, Stanford, CA Abstract

More information

COMBINED ADAPTIVE CONTROLLER FOR UAV GUIDANCE

COMBINED ADAPTIVE CONTROLLER FOR UAV GUIDANCE COMBINED ADAPTIVE CONTROLLER FOR UAV GUIDANCE B.R. Andrievsky, A.L. Fradkov Institute for Problems of Mechanical Engineering of Russian Academy of Sciences 61, Bolshoy av., V.O., 199178 Saint Petersburg,

More information

Modeling of Vehicle Dynamics using Matrix-Vector Oriented Calculation in Matlab.

Modeling of Vehicle Dynamics using Matrix-Vector Oriented Calculation in Matlab. CAINE 996, pp 5-2. ISCA, Orlando FL, Dec. 996 Modeling of Vehicle Dynamics using Matrix-Vector Oriented Calculation in Matlab. G. Edzko Smid, Ka C. Cheok and K. Kobayashi Department of Electrical and Systems

More information

Coupled Longitudinal and Lateral Control for an Autonomous Vehicle Dynamics Modeled Using a Robotics Formalism

Coupled Longitudinal and Lateral Control for an Autonomous Vehicle Dynamics Modeled Using a Robotics Formalism Coupled Longitudinal and Lateral Control for an Autonomous Vehicle Dynamics Modeled Using a Robotics Formalism Alia Chebly, R Talj, A. Charara To cite this version: Alia Chebly, R Talj, A. Charara. Coupled

More information

Nonlinear Hierarchical Control Allocation for Vehicle Yaw Stabilization and Rollover Prevention

Nonlinear Hierarchical Control Allocation for Vehicle Yaw Stabilization and Rollover Prevention Nonlinear Hierarchical Control Allocation for Vehicle Yaw Stabilization and Rollover Prevention Matthäus B. Alberding,, Johannes jønnås, or A. Johansen Department of Engineering Cybernetics, Norwegian

More information

A Stable Block Model Predictive Control with Variable Implementation Horizon

A Stable Block Model Predictive Control with Variable Implementation Horizon American Control Conference June 8-,. Portland, OR, USA WeB9. A Stable Block Model Predictive Control with Variable Implementation Horizon Jing Sun, Shuhao Chen, Ilya Kolmanovsky Abstract In this paper,

More information

The PVTOL Aircraft. 2.1 Introduction

The PVTOL Aircraft. 2.1 Introduction 2 The PVTOL Aircraft 2.1 Introduction We introduce in this chapter the well-known Planar Vertical Take-Off and Landing (PVTOL) aircraft problem. The PVTOL represents a challenging nonlinear systems control

More information

Offset Free Model Predictive Control

Offset Free Model Predictive Control Proceedings of the 46th IEEE Conference on Decision and Control New Orleans, LA, USA, Dec. 12-14, 27 Offset Free Model Predictive Control Francesco Borrelli, Manfred Morari. Abstract This work addresses

More information

Physics 12. Unit 5 Circular Motion and Gravitation Part 1

Physics 12. Unit 5 Circular Motion and Gravitation Part 1 Physics 12 Unit 5 Circular Motion and Gravitation Part 1 1. Nonlinear motions According to the Newton s first law, an object remains its tendency of motion as long as there is no external force acting

More information

Backstepping based approach for the combined longitudinal-lateral vehicle control

Backstepping based approach for the combined longitudinal-lateral vehicle control Intelligent Vehicles Symposium Alcalá de Henares, Spain, June 3-7, Backstepping based approach for the combined longitudinal-lateral vehicle control Lamri Nehaoua and Lydie Nouvelière Abstract This paper

More information

Introduction to Model Predictive Control. Dipartimento di Elettronica e Informazione

Introduction to Model Predictive Control. Dipartimento di Elettronica e Informazione Introduction to Model Predictive Control Riccardo Scattolini Riccardo Scattolini Dipartimento di Elettronica e Informazione Finite horizon optimal control 2 Consider the system At time k we want to compute

More information

Real-Time Obstacle Avoidance for trailer-like Systems

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

More information

Line following of a mobile robot

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

More information

Idle speed control using linear time varying model predictive control and discrete time approximations

Idle speed control using linear time varying model predictive control and discrete time approximations 2010 IEEE International Conference on Control Applications Part of 2010 IEEE Multi-Conference on Systems and Control Yokohama, Japan, September 8-10, 2010 Idle speed control using linear time varying model

More information

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

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

More information

arxiv: v1 [cs.sy] 2 Oct 2018

arxiv: v1 [cs.sy] 2 Oct 2018 Non-linear Model Predictive Control of Conically Shaped Liquid Storage Tanks arxiv:1810.01119v1 [cs.sy] 2 Oct 2018 5 10 Abstract Martin Klaučo, L uboš Čirka Slovak University of Technology in Bratislava,

More information

Development of a Dynamical Model for Retina-based Control of an RC Monster Truck

Development of a Dynamical Model for Retina-based Control of an RC Monster Truck Robin Ritz Development of a Dynamical Model for Retina-based Control of an RC Monster Truck Bachelor Project Automatic Control Laboratory Swiss Federal Institute of Technology (ETH) Zurich Advisors Thomas

More information

Towards Time-Optimal Race Car Driving using Nonlinear MPC in Real-Time

Towards Time-Optimal Race Car Driving using Nonlinear MPC in Real-Time 53rd IEEE Conference on Decision and Control December 15-17, 214. Los Angeles, California, USA Towards Time-Optimal Race Car Driving using Nonlinear MPC in Real-Time Robin Verschueren, Stijn De Bruyne,

More information

Design of observers for Takagi-Sugeno fuzzy models for Fault Detection and Isolation

Design of observers for Takagi-Sugeno fuzzy models for Fault Detection and Isolation Design of observers for Takagi-Sugeno fuzzy models for Fault Detection and Isolation Abdelkader Akhenak, Mohammed Chadli, José Ragot and Didier Maquin Institut de Recherche en Systèmes Electroniques Embarqués

More information

arxiv: v2 [cs.sy] 30 Nov 2018

arxiv: v2 [cs.sy] 30 Nov 2018 AVEC 18 Adaptive MPC for Autonomous Lane Keeping arxiv:186.4335v2 [cs.sy] 3 Nov 218 Monimoy Bujarbaruah & Xiaojing Zhang & Francesco Borrelli Department of Mechanical Engineering University of California

More information

Team-Exercises for DGC 100 Modelica Course

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

More information

Optimal Control of Nonlinear Systems: A Predictive Control Approach

Optimal Control of Nonlinear Systems: A Predictive Control Approach Optimal Control of Nonlinear Systems: A Predictive Control Approach Wen-Hua Chen a Donald J Ballance b Peter J Gawthrop b a Department of Aeronautical and Automotive Engineering, Loughborough University,

More information

Road bank angle estimation for three wheel tilting vehicle using multi model estimator

Road bank angle estimation for three wheel tilting vehicle using multi model estimator Road ban angle estimation for three wheel tilting vehicle using multi model estimator Kicheol Jeong, Seibum Choi,a KAIST, Department of Mechanical Engineering, 3 Deajeon, Republic of Korea Abstract. In

More information

MODELLING AND CONTROL OF A VEHICLE WITH SINGLE-WHEEL CHASSIS ACTUATORS. Ralf Orend

MODELLING AND CONTROL OF A VEHICLE WITH SINGLE-WHEEL CHASSIS ACTUATORS. Ralf Orend MODELLING AND CONTROL OF A VEHICLE WITH SINGLE-WHEEL CHASSIS ACTUATORS Ralf Orend Lehrstuhl für Regelungstechnik Universität Erlangen-Nürnberg Cauerstraße 7, 958 Erlangen, German ralf.orend@rt.eei.uni-erlangen.de

More information

A Globally Stabilizing Receding Horizon Controller for Neutrally Stable Linear Systems with Input Constraints 1

A Globally Stabilizing Receding Horizon Controller for Neutrally Stable Linear Systems with Input Constraints 1 A Globally Stabilizing Receding Horizon Controller for Neutrally Stable Linear Systems with Input Constraints 1 Ali Jadbabaie, Claudio De Persis, and Tae-Woong Yoon 2 Department of Electrical Engineering

More information

Path Following for Marine Surface Vessels with Rudder and Roll Constraints: an MPC Approach

Path Following for Marine Surface Vessels with Rudder and Roll Constraints: an MPC Approach 2009 American Control Conference Hyatt Regency Riverfront, St. Louis, MO, USA June 10-12, 2009 ThC11.6 Path Following for Marine Surface Vessels with Rudder and Roll Constraints: an MPC Approach Zhen Li,

More information

FINITE HORIZON ROBUST MODEL PREDICTIVE CONTROL USING LINEAR MATRIX INEQUALITIES. Danlei Chu, Tongwen Chen, Horacio J. Marquez

FINITE HORIZON ROBUST MODEL PREDICTIVE CONTROL USING LINEAR MATRIX INEQUALITIES. Danlei Chu, Tongwen Chen, Horacio J. Marquez FINITE HORIZON ROBUST MODEL PREDICTIVE CONTROL USING LINEAR MATRIX INEQUALITIES Danlei Chu Tongwen Chen Horacio J Marquez Department of Electrical and Computer Engineering University of Alberta Edmonton

More information

Controllers for an Autonomous Vehicle Treating Uncertainties as Deterministic Values. Chan Kyu Lee

Controllers for an Autonomous Vehicle Treating Uncertainties as Deterministic Values. Chan Kyu Lee Controllers for an Autonomous Vehicle Treating Uncertainties as Deterministic Values by Chan Kyu Lee A dissertation submitted in partial satisfaction of the requirements for the degree of Doctor of Philosophy

More information

Derivation of a Six Degrees-of-Freedom Ground-Vehicle Model for Automotive Applications

Derivation of a Six Degrees-of-Freedom Ground-Vehicle Model for Automotive Applications Derivation of a Six Degrees-of-Freedom Ground-Vehicle Model for Automotive Applications Berntorp, Karl Published: 2013-01-01 Document Version Publisher's PDF, also known as Version of record Link to publication

More information

VEHICLE MODELS AND ESTIMATION OF CONTACT FORCES AND TIRE ROAD FRICTION

VEHICLE MODELS AND ESTIMATION OF CONTACT FORCES AND TIRE ROAD FRICTION VEHICLE MODELS AND ESTIMATION OF CONTACT FORCES AND TIRE ROAD FRICTION Nacer K M Sirdi LSIS, CNRS UMR 6168 Dom Univ St Jrme, Av Escadrille Normandie - Niemen 13397 Marseille Cedex 2 France Email nacermsirdi@lsisorg;

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

EXPERIMENTAL COMPARISON OF TRAJECTORY TRACKERS FOR A CAR WITH TRAILERS

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

More information

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

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

Research Article Development and Verification of the Tire/Road Friction Estimation Algorithm for Antilock Braking System

Research Article Development and Verification of the Tire/Road Friction Estimation Algorithm for Antilock Braking System Mathematical Problems in Engineering Volume 24, Article ID 786492, 5 pages http://dx.doi.org/.55/24/786492 Research Article Development and Verification of the Tire/Road Friction Estimation Algorithm for

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

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

Statement: This paper will also be published during the 2017 AUTOREG conference.

Statement: This paper will also be published during the 2017 AUTOREG conference. Model Predictie Control for Autonomous Lateral Vehicle Guidance M. Sc. Jochen Prof. Dr.-Ing. Steffen Müller TU Berlin, Institute of Automotie Engineering Germany Statement: This paper will also be published

More information

(c) McHenry Software. McHenry. Accident Reconstruction. by Raymond R. McHenry Brian G. McHenry. McHenry Training Seminar 2008

(c) McHenry Software. McHenry. Accident Reconstruction. by Raymond R. McHenry Brian G. McHenry. McHenry Training Seminar 2008 McHenry Training eminar 008 McHenry Accident Reconstruction 008 by Raymond R. McHenry Brian G. McHenry McHenry oftware PO Box 1716 Cary, NC 751 UA (919)-468-966 email: mchenry@mchenrysoftware.com www:

More information

Vehicle Dynamics CEE 320. Winter 2006 CEE 320 Steve Muench

Vehicle Dynamics CEE 320. Winter 2006 CEE 320 Steve Muench Vehicle Dynamics Steve Muench Outline 1. Resistance a. Aerodynamic b. Rolling c. Grade. Tractive Effort 3. Acceleration 4. Braking Force 5. Stopping Sight Distance (SSD) Main Concepts Resistance Tractive

More information

Lane Departure Assist: A Formal Approach

Lane Departure Assist: A Formal Approach Lane Departure Assist: A Formal Approach Daniel Hoehener 1, Geng Huang 2 and Domitilla Del Vecchio 3 Abstract We use a controlled invariance approach to design a semi-autonomous lane departure assist system

More information