1 INTRODUCTION 2 PROBLEM DEFINITION

Size: px
Start display at page:

Download "1 INTRODUCTION 2 PROBLEM DEFINITION"

Transcription

1 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, CA, USA. ABSTRACT: This paper presents a longitudinal control algorithm for autonomous vehicles on highways. The focus is on identifying target vehicles in the scene which are relevant from a control perspective. These not only include vehicles in the ego vehicle s lane, but also those in neighboring lanes that are likely to cut in. A learning-based framework is used to estimate the lane change probability of such vehicles and identify relevant targets. The ability of the proposed approach to detect target vehicle cut-ins early and yield smoother control actions is demonstrated using data collected from a passenger vehicle in real traffic on a highway. 1 INTRODUCTION Autonomous or Adaptive Cruise Control (ACC) systems are present in many commercial vehicles today. By controlling the speed of the ego vehicle to match the speed limit and adapting the speed to that of the car in front, these systems help prevent rear-end collisions and relieve the driver of a tedious task. Moreover, they can easily be combined with autonomous lane-keeping systems to provide full autonomy on highways. Typically, ACC systems focus on one target vehicle at a time, namely the one currently in front of the ego vehicle. In this paper, we propose an improved algorithm which can handle other vehicles cutting in front of the ego vehicle. 2 PROBLEM DEFINITION Commercial ACC systems use a combination of onboard radar and camera to identify a Primary Target (PT) - the car in front of the ego vehicle in its own lane. The relative distance and speed of the PT are then passed to the control algorithm, which determines an acceleration command for the ego vehicle such that a safe following distance is maintained. If a PT is not detected, the controller tracks a desired speed such as the road speed limit. A challenging scenario for current ACC systems is to deal with target vehicles in neighboring lanes cutting in to the lane of the ego vehicle. The authors in Müller et al. (2011) recognize the vehicle cutting in as the PT when the Time to Lane-Crossing (TLC) of the target vehicle is within a threshold. In Moon et al. (2010), a fuzzy logic approach is used to compute the probability of a target vehicle entering into the ego vehicle s lane. These approaches are rule-based and not robust to noisy measurements. Moreover, they assume the existence of a single PT. In the case of multiple target vehicles, existing approaches choose the most relevant one based on some heuristics. The contributions of this paper are as follows: Given the relative positions of surrounding vehicles from the sensor fusion system, and the road geometry from the camera, we propose a learning-based approach to estimate the probability of lane change for each vehicle in the scene. Target vehicles which are relevant for ACC (possibly more than one) are then identified in the ego vehicle s lane and adjacent lanes. We present a multi-target autonomous cruise controller. The reference acceleration is generated via a Learning-by-Demonstration (LbD) algorithm using the most relevant target vehicle (Lefèvre et al. 2016). The control strategy is based on robust Model Predictive Control (MPC), where the safety constraints are imposed for all relevant vehicles. This avoids the need for rules to decide the most safety-critical target vehicle. The effectiveness of the proposed approach is demonstrated using data collected from our test vehicle. The sensor fusion and control algorithms are capable of running in real-time on embedded rapid control prototyping platforms. A schematic of the system architecture is shown in Figure 1. The Sensor Fusion module combines the measurements from the sensors such as radar, camera, lidar and GPS/INS to provide estimates of

2 the open-source solver ECOS for solving the optimization problem (Domahidi et al. 2013). A fused measurement of each associated TV s states is obtained by a convex combination of the measurements from each sensor. Additionally, a Kalman filter is used to estimate the relative positions and velocities of the TVs with respect to the EV. Figure 1: System architecture (described in Section 2). This paper focuses on the integration of the Sensor Fusion, Relevant Target Identification and Controller modules for ACC. the relative positions and velocities of target vehicles (TVs) in front of the ego vehicle (EV). The Relevant Target Identification module computes lane change probabilities of the detected TVs and identifies relevant TVs for ACC. These are denoted as Relevant Targets (RTs) as opposed to a single PT in the case of conventional ACC systems. Based on the above information, the Controller computes the desired acceleration command for the Vehicle. The remainder of the paper is organized as follows. Section 3 discusses the sensor fusion approach. The identification of RTs and the control algorithm are presented in Sections 4 and 5, respectively. Experimental results are discussed in Section 6 and concluding remarks are made in Section 7. 3 SENSOR FUSION AND TRACKING The experimental vehicle used for this application is equipped with a radar, camera and lidar. Each sensor reports the relative positions and velocities of the TVs in front of the EV with respect to its body fixed coordinate frame. The main challenge of sensor fusion is data association, that is, deciding which measurements from the three sensors originate from the same TV. In our case, the individual sensors perform their own tracking, so we use a globally optimal probabilistic track-to-track association algorithm to determine which tracks pertain to the same realworld object. Based on the work of Deb et al. (1997), we formulate the problem as a variation of the 3-dimensional assignment problem. Measurements from each of the three sensor tracks are grouped into triples to represent the hypothesis that those measurements have a common origin. The output of the algorithm is the optimal assignment which minimizes a chosen cost function. The cost of a triple is defined to be the negative log of the ratio of the probability that all three measurements in the triple pertain to the same object to the probability that all three measurements are spurious. The cost function is then the sum of the costs of all possible triples. The resulting optimization problem is a Mixed Integer Linear Program (MILP) which can be solved online. We use 4 IDENTIFICATION OF RELEVANT TARGETS The main focus of this paper is to account for TVs cutting in to the path of the EV. This section presents a learning-based approach to infer the lane changing intent of vehicles in the neighboring lanes. Based on the work of Lefèvre et al. (2014), we model the lane change decision making process for a given TV as a Hidden Markov Model (HMM). We define the following variables: m t M = {LK, LCL, LCR} is the hidden mode or latent variable at time instant t (LK = lane keeping, LCL = lane change left, LCR = lane change right). z t is the observed variable at time instant t. In our case, z t = e yt, where e y is the lateral position of the TV with respect to the centerline of the nearest lane. The variable e y is estimated using a combination of the position of the TV relative to the EV obtained from the sensor fusion system and the road geometry information provided by the camera on the EV. Remark 1. Additional features such as the relative orientation of the TV with respect to its lane can be used to improve the performance of the lane change intention estimation. The joint probability distribution of the modes m 0:t = {m 0,..., m t } and the observations z 1:t = {z 1,..., z t } is given by P (m 0:t,z 1:t ) = P (m 0 ) t P (m k m k 1 )P (z k m k ), k=1 (1) where the emission probability density function P (z k m k ) is modeled as a Gaussian distribution. The parameters which characterize the prior and transition probability mass functions P (m 0 ) and P (m k m k 1 ), respectively, and the means and covariances of the Gaussian emission density function are learned from data collected from our test vehicle using the Expectation-Maximization (EM) algorithm and the Bayesian Information Criterion (Lefèvre et al. 2014). During online operation, at time t, inference on the HMM gives us a probability distribution over the hidden mode m t for each TV conditioned on the history

3 of observations z 1:t. That is, P (m t = i z 1:t ) can be recursively computed as P (m t = i z 1:t ) P (z t m t = i) P (m t 1 = j z 1:t 1 )P (m t = i m t 1 = j), (2) j M initialized with the prior distribution P (m 0 ). The most likely mode m ML t at time t is defined as m ML t = arg max i M P (m t = i z 1:t ). (3) Among all TVs in front of the EV, we define the RTs as the TVs in the EV s lane, the TVs in the adjacent left lane whose most likely mode m ML t = LCR, the TVs in the adjacent right lane whose most likely mode m ML t = LCL. The relative distances and velocities of the RTs are then passed to the controller described below. In the absence of a vehicle satisfying the above criteria, a free-flow mode is triggered wherein the controller tracks the road speed limit or a user-defined reference speed as in conventional cruise control systems. 5 CONTROLLER The control strategy is based on combining LbD with MPC, previously presented in Lefèvre et al. (2016). The idea is to leverage the non-parametric nature of LbD and the safety guarantees provided by MPC. We extend our methodology to account for multiple RTs. A review of the control design is presented below. The details can be found in Lefèvre et al. (2016). a t is the acceleration of the EV at time instant t. The joint distribution of the modes m 0:t = {m 0,..., m t }, observations z 1:t = {z 1,..., z t } and accelerations a 1:t = {a 1,..., a t } is given by P (m 0:t, z 1:t, a 1:t ) = t P (m 0 ) P (m k m k 1 )P (z k, a k m k ). (4) k=1 where the emission density function P (z k, a k m k = i) is modeled as a Gaussian N (µ i, Σ i ). The parameters that characterize the distributions in (4) are learned from data collected from a single driver. This allows us to personalize the driving behavior of the autonomous vehicle (Lefèvre et al. 2016). During online operation, the reference acceleration a ref t at time t is computed using Gaussian Mixture Regression (GMR) as a ref t = E[a t z 1:t ] = M P (m t = i z 1:t )[µ a i + Σ az i (Σ zz i ) 1 (z t µ z i )], (5) i=1 where P (m t = i z 1:t ) is computed by the recursive algorithm in (2) and [ ] [ ] µ z µ i = i Σ zz µ a, Σ i = i Σ za i i Σ az i Σ aa. (6) i A sequence of reference accelerations a ref t:t+n over a desired time horizon N can be obtained by iteratively simulating a ref through the vehicle dynamics (described later in Section 5.2.3) and running (5) using the simulated features. In order to compute the predicted values of the features, the most relevant TV is assumed to move at a constant velocity over the horizon N. 5.1 Learning-by-Demonstration (LbD) The goal of LbD is to generate a reference acceleration for the MPC-based controller for the given driving situation. We use the frameworks of HMMs and Gaussian Mixture Regression (GMR) in this work. Similar to Section 4, the car-following behavior of the driver is modeled as a HMM. We define the following variables: m t {1,..., M} is the hidden mode at time instant t, where M is the number of hidden modes. z t = [d r t, v r t, v t ] is the vector of observations at time t, where d r and v r are the relative distance and relative velocity of the most relevant TV, respectively, and v is the velocity of the EV. The determination of the most relevant target among the RTs is discussed later in Section Model Predictive Control (MPC) The reference acceleration is tracked by a robust MPC-based controller where the future accelerations of the RTs are assumed to be bounded disturbances. The control inputs are chosen such that the collision avoidance constraints are satisfied for all possible values of this disturbance. The formulation of the robust safety constraints for the case of a single PT is introduced in Lefèvre et al. (2016) and summarized below. The approach is extended to handle all RTs present at the current time step Robust safety constraints In order to ensure that the EV avoids rear-end collisions with the RTs for all possible future accelerations of the RTs, we take a worst-case approach. That is, the RTs are assumed to apply maximum braking

4 starting from their current positions and velocities till they come to a halt. In Lefèvre et al. (2016), we show that the resulting safety constraints on the position and velocity of the EV over the prediction horizon for a given RT can be written as d p t+k d t+k d safe (k = 1,..., N 1) (7) d p t+n d t+n + v2 t+n 2a min ( vp t+n )2 a p min d safe, (8) where d p t+1:t+n and vp t+1:t+n are the predicted positions and velocities of the RT assuming a maximum braking of a p min. The variable a min is the maximum deceleration that be commanded by the controller on the EV and d safe is the minimum relative safety distance. Note that the constraints (7) and (8) are imposed for all RTs present at time t Safety margin Equation (8) introduces the notion of a safety margin. Intuitively, the LHS of (8) is the distance between the EV and the RT when they stop after applying maximum braking. For a given RT, we define the normalized braking distance (NBD) at time t as follows: NBD t = 1 d safe ( d p t d t + v2 t (vp t ) 2 2a min a p min ). (9) We use this metric to determine the most relevant TV for the LbD approach presented in Section 5.1. That is, among the detected RTs, the vehicle with the smallest NBD is chosen as the most relevant TV. This metric is also used to compare the performance of our algorithm against existing approaches in the next section Longitudinal dynamics model The following linear difference equations are used to describe the longitudinal motion of the EV for the MPC design: [ ] dt+1 ξ t+1 := v t+1 [ dt + T = s v t + 1T ] 2 2 s a t =: f(ξ v t + T s a t, a t ), (10) t where ξ t and a t denote the EV state and control input at time t, respectively, and T s is the sampling time Online optimization problem In MPC, at each time step, a constrained finite horizon optimal control problem is solved. The first control input from the optimal input sequence is implemented, and the process is repeated at the next time step with the new measurements. At time t, the optimization problem to be solved online is given by min a t,ɛ N 1 k=0 ( vt+k+1 v ref 2 Q + a t+k a ref t+k 2 R+ a t+k 2 P ) + Sɛ (11a) s.t. ξ t+k+1 = f(ξ t+k, a t+k ) (11b) d p i t+k+1 d t+k+1 d safe ɛ (i = 1,..., N RT ) (11c) a t+k = a t+k a t+k 1 a min a t+k a max a min a t+k a max (k = 0,..., N 1) d p i t+n d t+n + v2 t+n ( vpi 2a min t+n )2 a p min d safe ɛ (11d) (11e) (11f) (i = 1,..., N RT ) (11g) ξ t = ξ(t), a t 1 = a(t 1), ɛ 0, (11h) where the expression z 2 M = zt Mz for a variable z and a t denotes the control input sequence {a t,..., a t+n 1 } to be optimized over. The reference speed is denoted by v ref and the tracking error is penalized with a small value in Q. Actuator magnitude and slew rate limits are enforced in (11e) and (11f), respectively. The safety constraints (11c) and (11g) are imposed as soft constraints with a high penalty S on the slack variable ɛ. The subscript i in (11c) and (11g) denotes the i th vehicle out of the N RT RTs present at time t. The optimization problem (11) is a standard nonlinear program which we solve using NPSOL (Gill et al. 1986). 6 EXPERIMENTS The proposed ACC system was tested using sensory data collected from our experimental vehicle. Note that the system is capable of running in real-time on embedded rapid control prototyping platforms (see Lefèvre et al. (2016) for details). In this work, for a fair comparison of the proposed strategy with existing approaches, we simulate the effect of the control input on the motion of the EV but use real data to reconstruct the environment. It is assumed that the EV has no influence on TVs that cut-in to its path. The evaluation process is explained in more detail below. 6.1 Data collection and scene reconstruction We collected manual driving data from our on-board vehicle sensors (radar, camera, lidar, GPS/INS) on highways. In order to accurately reconstruct the evolution of the environment, the inertial motion of the EV is estimated using the GPS/INS measurements. Combining this with the relative motion of the TVs perceived by the outward looking sensors allows us to estimate the inertial motion of the TVs. It is then straightforward to compute the apparent relative motion of the TVs with respect to the EV during a simulation involving the proposed controller. The TV data

5 is passed to the sensor fusion and RT identification algorithms. The resulting RT data is used as an input to the MPC-based controller. Finally, the EV motion is simulated using (10), hence closing the loop. We focus specifically on short segments of the datasets (around s each) which involve a cut-in maneuver by a TV in the neighboring lane. The segment start time is chosen to be a few seconds before the TV initiates the lane change and the end time is when the TV completes the lane change. 6.2 Evaluation methodology We compare the performance of the proposed ACC approach (denoted as ACC 1) with the existing ACC system implemented on our experimental vehicle (denoted as ACC 2). Note that the existing system uses a combination of radar and camera without any lane change intent estimation to identify a single PT. The PT identification is based on whether a candidate TV lies in a virtual lane constructed on the basis of the longitudinal velocity and yaw rate of the EV. The main difference between ACC 1 and ACC 2 lies in the identification of the RTs or the PT. For a fair evaluation, the same control strategy (presented in Section 5) is used for both approaches. For each segment of the dataset involving a simulation of either ACC 1 or ACC 2, we compute the following metrics: 1. Absolute values of the mean and maximum deceleration, µ a and p a, respectively. 2. Absolute values of the mean and maximum negative jerk, µ j and p j, respectively. 3. Minimum normalized braking distance, NBD, as defined in (9), computed for the most relevant TV. 4. Maximum inverse time-to-collision, TTC i, defined as the ratio of the relative speed of the EV with respect to the most relevant RT and the relative distance. Metrics (1) and (2) characterize the comfort of the system, where lower values correspond to a smoother behavior. Metrics (3) and (4) characterize the safety. A higher value of the NBD is desired while a lower value of TTC i implies lower collision risk. 6.3 Results For a given approach (ACC 1 or ACC 2), the mean and standard deviation of the quantities described in Section 6.2 were computed for 28 segments from 4 datasets and are tabulated in Table 1. We see that ACC 1 yields lower values of the mean and maximum deceleration as compared to ACC 2 resulting in a more comfortable experience for the driver. The Metric Unit ACC 1 ACC 2 µ a m/s ± ± 0.91 p a m/s ± ± 1.17 µ j m/s ± ± 1.68 p j m/s ± ± 1.29 NBD ± ± 3.43 TTC i s ± ± 1.24 Table 1: Means and standard deviations of the metrics defined in Section 6.2 for the proposed approach (ACC 1) and the existing approach (ACC 2) computed from 28 simulations. Acceleration [m/s 2 ] ACC1 ACC Time [s] Figure 2: Comparison of the closed-loop acceleration profiles during a simulation of the scenario described in Section 6.3 of the proposed approach (ACC 1, solid line) and the existing approach (ACC 2, dashed line). ACC 1 results in a smoother acceleration command that ACC 2. difference in the mean and peak negative jerk is less marked. This can be attributed to the fact that only aggressive cut-in maneuvers were selected for the analysis which required a sudden change in the acceleration commanded by the controller. The average values of the NBD and TTC i show that ACC 1 yields a safer behavior than ACC 2, validating the consideration of TVs lane change intentions. We further analyze an interesting and challenging situation recorded in one of the datasets where two TVs changed lanes in front of the EV within a short span of time. At time t = 5.4 s (from an arbitrary t = 0), the first TV (TV 1) crosses the right boundary of the EV s lane, followed by the second TV (TV 2) at time t = 9.2 s. The small relative distance and lower speeds of the TVs necessitates a braking maneuver by the EV. Figure 2 shows a comparison of the acceleration profiles for ACC 1 and ACC 2 when this scenario is reconstructed in simulation. It is seen that due to the lane change estimation of TV 1, ACC 1 starts braking at t = 4.3 s, 1.2 s before ACC 2, resulting in a smoother acceleration profile. Later, when TV 2 cuts in, ACC 1 responds at t = 8.1 s, 1.8 s before ACC 2. The deceleration command saturates in the case of ACC 2 but not in the case of ACC 1. A comparison of the metrics defined in Section 6.2 for both approaches is shown in Table 2.

6 Metric Unit ACC 1 ACC 2 µ a m/s p a m/s µ j m/s p j m/s NBD TTC i s Table 2: Comparison of the metrics defined in Section 6.2 for ACC 1 and ACC 2 during a simulation of the scenario described in Section 6.3. Most Likely Intent Lateral Position [m] RT Flag LCR LCL LK ACC1 ACC Time [s] Figure 3: Results of the relevant target identification for a TV cut-in scenario from one of the datasets (described in Section 6.4). ACC 1 identifies the RT 1.85 s before ACC Relevant target identification performance Finally, we compare the performance of the proposed RT identification methodology presented in Section 4 (ACC 1) against the existing approach (ACC 2). The metric used is the time difference between the two approaches recognizing a cutting-in TV as a RT or PT. It is observed that our method identifies a RT 1.28 ± 0.26 s before the existing approach. The trajectory of a TV s lateral position e y while it performs a cut-in maneuver from one of the datasets is shown in top plot of Figure 3. The middle plot shows the estimated most likely mode (defined in Section 4). We see that the estimator switches to the lane change right (LCR) mode 1.4 s before the estimated center of mass of the TV crosses the lane boundary. The bottom plot of Figure 3 depicts the binary variable indicating whether or not the TV has been identified as a RT for both methods ACC 1 and ACC 2. It is seen that ACC 1 identifies the RT 1.85 s before ACC 2 in this scenario. 7 CONCLUSIONS This paper presents an approach for detecting target vehicle cut-ins for ACC systems. Data from multiple sensors (radar, camera and lidar) are fused to estimate target vehicles positions in their lanes. A learning-based lane change intention estimation algorithm identifies target vehicles which may change lanes into the path of the ego vehicle. A control strategy based on robust MPC is presented which considers safety with respect to all relevant target vehicles without the need for heuristics to select a single primary target. The proposed methodology is shown to improve the performance of the ACC system as compared to an existing approach, based on several metrics that consider comfort and safety. ACKNOWLEDGMENTS The authors would like to thank the Hyundai Motor Company for their support. REFERENCES Deb, S., M. Yeddanapudi, K. Pattipati, & Y. Bar-Shalom (1997). A generalized S-D assignment algorithm for multisensor-multitarget state estimation. IEEE Transactions on Aerospace and Electronic Systems 33(2), Domahidi, A., E. Chu, & S. Boyd (2013). ECOS: An SOCP solver for embedded systems. In European Control Conference (ECC), pp Gill, P. E., W. Murray, M. A. Saunders, & M. H. Wright (1986). User s guide for NPSOL (version 4.0): A Fortran package for nonlinear programming. No. SOL Stanford University Systems Optimization Lab. Lefèvre, S., A. Carvalho, & F. Borrelli (2016). A learningbased framework for velocity control in autonomous driving. IEEE Transactions on Automation Science and Engineering. Lefèvre, S., Y. Gao, D. Vasquez, E. Tseng, R. Bajcsy, & F. Borrelli (2014). Lane keeping assistance with learning-based driver model and model predictive control. In Proc. 12th International Symposium on Advanced Vehicle Control. Moon, S., H.-J. Kang, & K. Yi (2010). Multi-vehicle target selection for adaptive cruise control. Vehicle System Dynamics 48(11), Müller, D., J. Pauli, M. Meuter, L. Ghosh, & S. Müller- Schneiders (2011). A generic video and radar data fusion system for improved target selection. In 2011 IEEE Intelligent Vehicles Symposium (IV), pp

Autonomous Car Following: A Learning-Based Approach

Autonomous Car Following: A Learning-Based Approach Autonomous Car Following: A Learning-Based Approach Stéphanie Lefèvre, Ashwin Carvalho, Francesco Borrelli Abstract We propose a learning-based method for the longitudinal control of an autonomous vehicle

More information

Convolution Neural Network-based Lane Change Intention Prediction of Surrounding Vehicles for ACC

Convolution Neural Network-based Lane Change Intention Prediction of Surrounding Vehicles for ACC Convolution Neural Network-based Lane Change Intention Prediction of Surrounding Vehicles for ACC Donghan Lee, Youngwook Paul Kwon, Sara McMains, and J. Karl Hedrick Abstract Adaptive cruise control is

More information

A Learning-Based Framework for Velocity Control in Autonomous Driving

A Learning-Based Framework for Velocity Control in Autonomous Driving 32 IEEE TRANSACTIONS ON AUTOMATION SCIENCE AND ENGINEERING, VOL. 13, NO. 1, JANUARY 2016 A Learning-Based Framework for Velocity Control in Autonomous Driving Stéphanie Lefèvre, Ashwin Carvalho, and Francesco

More information

THE POTENTIAL OF APPLYING MACHINE LEARNING FOR PREDICTING CUT-IN BEHAVIOUR OF SURROUNDING TRAFFIC FOR TRUCK-PLATOONING SAFETY

THE POTENTIAL OF APPLYING MACHINE LEARNING FOR PREDICTING CUT-IN BEHAVIOUR OF SURROUNDING TRAFFIC FOR TRUCK-PLATOONING SAFETY THE POTENTIAL OF APPLYING MACHINE LEARNING FOR PREDICTING CUT-IN BEHAVIOUR OF SURROUNDING TRAFFIC FOR TRUCK-PLATOONING SAFETY Irene Cara Jan-Pieter Paardekooper TNO Helmond The Netherlands Paper Number

More information

A Probabilistic Relational Model for Characterizing Situations in Dynamic Multi-Agent Systems

A Probabilistic Relational Model for Characterizing Situations in Dynamic Multi-Agent Systems A Probabilistic Relational Model for Characterizing Situations in Dynamic Multi-Agent Systems Daniel Meyer-Delius 1, Christian Plagemann 1, Georg von Wichert 2, Wendelin Feiten 2, Gisbert Lawitzky 2, and

More information

A Probabilistic Relational Model for Characterizing Situations in Dynamic Multi-Agent Systems

A Probabilistic Relational Model for Characterizing Situations in Dynamic Multi-Agent Systems A Probabilistic Relational Model for Characterizing Situations in Dynamic Multi-Agent Systems Daniel Meyer-Delius 1, Christian Plagemann 1, Georg von Wichert 2, Wendelin Feiten 2, Gisbert Lawitzky 2, and

More information

arxiv: v1 [cs.sy] 21 Oct 2018

arxiv: v1 [cs.sy] 21 Oct 2018 Safe Adaptive Cruise Control with Road Grade Preview and V2V Communication Roya Firoozi, Shima Nazari, Jacopo Guanetti, Ryan O Gorman, Francesco Borrelli arxiv:1810.09000v1 [cs.sy] 21 Oct 2018 Abstract

More information

EE C128 / ME C134 Feedback Control Systems

EE C128 / ME C134 Feedback Control Systems EE C128 / ME C134 Feedback Control Systems Lecture Additional Material Introduction to Model Predictive Control Maximilian Balandat Department of Electrical Engineering & Computer Science University of

More information

Statistical Model Checking Applied on Perception and Decision-making Systems for Autonomous Driving

Statistical Model Checking Applied on Perception and Decision-making Systems for Autonomous Driving Statistical Model Checking Applied on Perception and Decision-making Systems for Autonomous Driving J. Quilbeuf 1 M. Barbier 2,3 L. Rummelhard 3 C. Laugier 2 A. Legay 1 T. Genevois 2 J. Ibañez-Guzmán 3

More information

Automated Driving The Role of Forecasts and Uncertainty - A Control Perspective

Automated Driving The Role of Forecasts and Uncertainty - A Control Perspective Automated Driving The Role of Forecasts and Uncertainty - A Control Perspective Ashwin Carvalho a,, Stéphanie Lefèvre a, Georg Schildbach a, Jason Kong a, Francesco Borrelli a a Department of Mechanical

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

Advanced Adaptive Cruise Control Based on Collision Risk Assessment

Advanced Adaptive Cruise Control Based on Collision Risk Assessment Advanced Adaptive Cruise Control Based on Collision Risk Assessment Hanwool Woo 1, Yonghoon Ji 2, Yusuke Tamura 1, Yasuhide Kuroda 3, Takashi Sugano 4, Yasunori Yamamoto 4, Atsushi Yamashita 1, and Hajime

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

Predictive Control under Uncertainty for Safe Autonomous Driving: Integrating Data-Driven Forecasts with Control Design. Ashwin Mark Carvalho

Predictive Control under Uncertainty for Safe Autonomous Driving: Integrating Data-Driven Forecasts with Control Design. Ashwin Mark Carvalho Predictive Control under Uncertainty for Safe Autonomous Driving: Integrating Data-Driven Forecasts with Control Design by Ashwin Mar Carvalho A dissertation submitted in partial satisfaction of the requirements

More information

Linear Dynamical Systems

Linear Dynamical Systems Linear Dynamical Systems Sargur N. srihari@cedar.buffalo.edu Machine Learning Course: http://www.cedar.buffalo.edu/~srihari/cse574/index.html Two Models Described by Same Graph Latent variables Observations

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

Towards Fully-automated Driving

Towards Fully-automated Driving Towards Fully-automated Driving Challenges and Potential Solutions Dr. Gijs Dubbelman Mobile Perception Systems EE-SPS/VCA Mobile Perception Systems 6 PhDs, postdoc, project manager, software engineer,

More information

TRAJECTORY PLANNING FOR AUTOMATED YIELDING MANEUVERS

TRAJECTORY PLANNING FOR AUTOMATED YIELDING MANEUVERS TRAJECTORY PLANNING FOR AUTOMATED YIELDING MANEUVERS, Mattias Brännström, Erik Coelingh, and Jonas Fredriksson Funded by: FFI strategic vehicle research and innovation ITRL conference Why automated maneuvers?

More information

Tracking and Identification of Multiple targets

Tracking and Identification of Multiple targets Tracking and Identification of Multiple targets Samir Hachour, François Delmotte, Eric Lefèvre, David Mercier Laboratoire de Génie Informatique et d'automatique de l'artois, EA 3926 LGI2A first name.last

More information

The Development of AMR Sensors for Vehicle Position Estimation

The Development of AMR Sensors for Vehicle Position Estimation Sonar 211 American Control Conference on O'Farrell Street, San Francisco, CA, USA June 29 - July 1, 211 The Development of AMR Sensors for Vehicle Position Estimation S. Taghvaeeyan and R. Rajamani 1 Abstract

More information

Parameter Estimation in a Moving Horizon Perspective

Parameter Estimation in a Moving Horizon Perspective Parameter Estimation in a Moving Horizon Perspective State and Parameter Estimation in Dynamical Systems Reglerteknik, ISY, Linköpings Universitet State and Parameter Estimation in Dynamical Systems OUTLINE

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

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

Traffic safety research: a challenge for extreme value statistics

Traffic safety research: a challenge for extreme value statistics Traffic safety research: a challenge for extreme value statistics VTTI Driving Transportation with Technology Jenny Jonasson, Astra-Zeneca, Gothenburg Holger Rootzén, Mathematical Sciences, Chalmers http://www.math.chalmers.se/~rootzen/

More information

Generating Fuzzy Rules for the Acceleration Control of an Adaptive Cruise Control System

Generating Fuzzy Rules for the Acceleration Control of an Adaptive Cruise Control System To appear in: Proceedings and at the NAFIPS conference, being held June9thnd, 995 in Berkeley, CA, USA. Generating Fuzzy Rules for the Acceleration Control of an Adaptive Cruise Control System R. Holve,

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

IMM vehicle tracking for traffic jam situations on highways

IMM vehicle tracking for traffic jam situations on highways IMM vehicle tracking for traffic jam situations on highways Nico Kaempchen, Klaus C.J. Dietmayer University of Ulm Dept. of Measurement, Control and Microtechnology Albert Einstein Allee 4 D 898 Ulm Germany

More information

Influence diagrams for speed profile optimization: computational issues

Influence diagrams for speed profile optimization: computational issues Jiří Vomlel, Václav Kratochvíl Influence diagrams for speed profile optimization: computational issues Jiří Vomlel and Václav Kratochvíl Institute of Information Theory and Automation Czech Academy of

More information

A model predictive controller for non-cooperative eco-platooning

A model predictive controller for non-cooperative eco-platooning A model predictive controller for non-cooperative eco-platooning Valerio Turri 1,, Yeojun Kim 2,, Jacopo Guanetti 2, Karl H. Johansson 1, Francesco Borrelli 2 Abstract This paper proposes an energy-saving

More information

STA 4273H: Statistical Machine Learning

STA 4273H: Statistical Machine Learning STA 4273H: Statistical Machine Learning Russ Salakhutdinov Department of Statistics! rsalakhu@utstat.toronto.edu! http://www.utstat.utoronto.ca/~rsalakhu/ Sidney Smith Hall, Room 6002 Lecture 11 Project

More information

Application of Adaptive Sliding Mode Control with an Ellipsoidal Sliding Surface for Vehicle Distance Control

Application of Adaptive Sliding Mode Control with an Ellipsoidal Sliding Surface for Vehicle Distance Control SICE Journal of Control, Measurement, and System Integration, Vol. 10, No. 1, pp. 05 031, January 017 Application of Adaptive Sliding Mode Control with an Ellipsoidal Sliding Surface for Vehicle Distance

More information

An adaptive cruise control for connected energy-saving electric vehicles

An adaptive cruise control for connected energy-saving electric vehicles An adaptive cruise control for connected energy-saving electric vehicles Lorenzo Bertoni Jacopo Guanetti Maria Basso Marco Masoero Sabri Cetinkunt Francesco Borrelli Department of Mechanical Engineering,

More information

Safe Control under Uncertainty

Safe Control under Uncertainty Safe Control under Uncertainty Dorsa Sadigh UC Berkeley Berkeley, CA, USA dsadigh@berkeley.edu Ashish Kapoor Microsoft Research Redmond, WA, USA akapoor@microsoft.com ical models [20] have been very popular

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

A Sufficient Comparison of Trackers

A Sufficient Comparison of Trackers A Sufficient Comparison of Trackers David Bizup University of Virginia Department of Systems and Information Engineering P.O. Box 400747 151 Engineer's Way Charlottesville, VA 22904 Donald E. Brown University

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

How would surround vehicles move? A Unified Framework for Maneuver Classification and Motion Prediction

How would surround vehicles move? A Unified Framework for Maneuver Classification and Motion Prediction JOURNAL NAME 1 How would surround vehicles move? A Unified Framework for Maneuver Classification and Motion Prediction Nachet Deo, Akshay Rangesh, and Mohan M. Trivedi, Fellow, IEEE Abstract Reliable prediction

More information

Overview of the Seminar Topic

Overview of the Seminar Topic Overview of the Seminar Topic Simo Särkkä Laboratory of Computational Engineering Helsinki University of Technology September 17, 2007 Contents 1 What is Control Theory? 2 History

More information

Fuzzy Inference-Based Dynamic Determination of IMM Mode Transition Probability for Multi-Radar Tracking

Fuzzy Inference-Based Dynamic Determination of IMM Mode Transition Probability for Multi-Radar Tracking Fuzzy Inference-Based Dynamic Determination of IMM Mode Transition Probability for Multi-Radar Tracking Yeonju Eun, Daekeun Jeon CNS/ATM Team, CNS/ATM and Satellite Navigation Research Center Korea Aerospace

More information

Scenario Model Predictive Control for Lane Change Assistance and Autonomous Driving on Highways

Scenario Model Predictive Control for Lane Change Assistance and Autonomous Driving on Highways Scenario Model Predictive Control for Lane Change Assistance and Autonomous Driving on Highways Gianluca Cesari, Georg Schildbach, Ashwin Carvalho, Francesco Borrelli Abstract This paper presents a novel

More information

A Study on Performance Analysis of V2V Communication Based AEB System Considering Road Friction at Slopes

A Study on Performance Analysis of V2V Communication Based AEB System Considering Road Friction at Slopes , pp. 71-80 http://dx.doi.org/10.14257/ijfgcn.2016.9.11.07 A Study on Performance Analysis of V2V Communication Based AEB System Considering Road Friction at Slopes Sangduck Jeon 1, Jungeun Lee 1 and Byeongwoo

More information

CHAPTER 3. CAPACITY OF SIGNALIZED INTERSECTIONS

CHAPTER 3. CAPACITY OF SIGNALIZED INTERSECTIONS CHAPTER 3. CAPACITY OF SIGNALIZED INTERSECTIONS 1. Overview In this chapter we explore the models on which the HCM capacity analysis method for signalized intersections are based. While the method has

More information

JOINT INTERPRETATION OF ON-BOARD VISION AND STATIC GPS CARTOGRAPHY FOR DETERMINATION OF CORRECT SPEED LIMIT

JOINT INTERPRETATION OF ON-BOARD VISION AND STATIC GPS CARTOGRAPHY FOR DETERMINATION OF CORRECT SPEED LIMIT JOINT INTERPRETATION OF ON-BOARD VISION AND STATIC GPS CARTOGRAPHY FOR DETERMINATION OF CORRECT SPEED LIMIT Alexandre Bargeton, Fabien Moutarde, Fawzi Nashashibi and Anne-Sophie Puthon Robotics Lab (CAOR),

More information

Overtaking & Receding Vehicle Detection for Driver Assistance and Naturalistic Driving Studies

Overtaking & Receding Vehicle Detection for Driver Assistance and Naturalistic Driving Studies Overtaking & Receding Vehicle Detection for Driver Assistance and Naturalistic Driving Studies Ravi Kumar Satzoda and Mohan M. Trivedi Abstract Although on-road vehicle detection is a wellresearched area,

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

Maarten Bieshaar, Günther Reitberger, Stefan Zernetsch, Prof. Dr. Bernhard Sick, Dr. Erich Fuchs, Prof. Dr.-Ing. Konrad Doll

Maarten Bieshaar, Günther Reitberger, Stefan Zernetsch, Prof. Dr. Bernhard Sick, Dr. Erich Fuchs, Prof. Dr.-Ing. Konrad Doll Maarten Bieshaar, Günther Reitberger, Stefan Zernetsch, Prof. Dr. Bernhard Sick, Dr. Erich Fuchs, Prof. Dr.-Ing. Konrad Doll 08.02.2017 By 2030 road traffic deaths will be the fifth leading cause of death

More information

vehicle velocity (m/s) relative velocity (m/s) 22 relative velocity (m/s) 1.5 vehicle velocity (m/s) time (s)

vehicle velocity (m/s) relative velocity (m/s) 22 relative velocity (m/s) 1.5 vehicle velocity (m/s) time (s) Proceedings of the 4th IEEE Conference on Decision and Control, New Orleans, LA, December 99, pp. 477{48. Variable Time Headway for String Stability of Automated HeavyDuty Vehicles Diana Yanakiev and Ioannis

More information

Collision warning system based on probability density functions van den Broek, T.H.A.; Ploeg, J.

Collision warning system based on probability density functions van den Broek, T.H.A.; Ploeg, J. Collision warning system based on probability density functions van den Broek, T.H.A.; Ploeg, J. Published in: Proceedings of the 7th International Workshop on Intelligent Transportation WIT 2010, 23-24

More information

Traffic Modelling for Moving-Block Train Control System

Traffic Modelling for Moving-Block Train Control System Commun. Theor. Phys. (Beijing, China) 47 (2007) pp. 601 606 c International Academic Publishers Vol. 47, No. 4, April 15, 2007 Traffic Modelling for Moving-Block Train Control System TANG Tao and LI Ke-Ping

More information

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

1 Introduction. 2 Successive Convexification Algorithm

1 Introduction. 2 Successive Convexification Algorithm 1 Introduction There has been growing interest in cooperative group robotics [], with potential applications in construction and assembly. Most of this research focuses on grounded or mobile manipulator

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

Optimal Mixture Approximation of the Product of Mixtures

Optimal Mixture Approximation of the Product of Mixtures Optimal Mixture Approximation of the Product of Mixtures Oliver C Schrempf, Olga Feiermann, and Uwe D Hanebeck Intelligent Sensor-Actuator-Systems Laboratory Institute of Computer Science and Engineering

More information

Performance Comparison of K-Means and Expectation Maximization with Gaussian Mixture Models for Clustering EE6540 Final Project

Performance Comparison of K-Means and Expectation Maximization with Gaussian Mixture Models for Clustering EE6540 Final Project Performance Comparison of K-Means and Expectation Maximization with Gaussian Mixture Models for Clustering EE6540 Final Project Devin Cornell & Sushruth Sastry May 2015 1 Abstract In this article, we explore

More information

Artificial Intelligence

Artificial Intelligence Artificial Intelligence Roman Barták Department of Theoretical Computer Science and Mathematical Logic Summary of last lecture We know how to do probabilistic reasoning over time transition model P(X t

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

arxiv: v1 [cs.ro] 14 Apr 2017

arxiv: v1 [cs.ro] 14 Apr 2017 Belief State Planning for Autonomously Navigating Urban Intersections Maxime Bouton, Akansel Cosgun, and Mykel J. Kochenderfer arxiv:74.43v [cs.ro] 4 Apr 7 Abstract Urban intersections represent a complex

More information

Complexity Metrics. ICRAT Tutorial on Airborne self separation in air transportation Budapest, Hungary June 1, 2010.

Complexity Metrics. ICRAT Tutorial on Airborne self separation in air transportation Budapest, Hungary June 1, 2010. Complexity Metrics ICRAT Tutorial on Airborne self separation in air transportation Budapest, Hungary June 1, 2010 Outline Introduction and motivation The notion of air traffic complexity Relevant characteristics

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

A Hierarchical Model-based Optimization Control Method for Merging of Connected Automated Vehicles. Na Chen, Meng Wang, Tom Alkim, Bart van Arem

A Hierarchical Model-based Optimization Control Method for Merging of Connected Automated Vehicles. Na Chen, Meng Wang, Tom Alkim, Bart van Arem A Hierarchical Model-based Optimization Control Method for Merging of Connected Automated Vehicles Na Chen, Meng Wang, Tom Alkim, Bart van Arem 1 Background Vehicle-to-Vehicle communication Vehicle-to-Infrastructure

More information

Moving Horizon Filter for Monotonic Trends

Moving Horizon Filter for Monotonic Trends 43rd IEEE Conference on Decision and Control December 4-7, 2004 Atlantis, Paradise Island, Bahamas ThA.3 Moving Horizon Filter for Monotonic Trends Sikandar Samar Stanford University Dimitry Gorinevsky

More information

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

A Model Predictive Control Approach for Combined Braking and Steering in Autonomous Vehicles 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

More information

Planning of Optimal Collision Avoidance Trajectories with Timed Elastic Bands

Planning of Optimal Collision Avoidance Trajectories with Timed Elastic Bands Preprints of the 19th World Congress The International Federation of Automatic Control Cape Town, South Africa. August -9, 1 Planning of Optimal Collision Avoidance Trajectories with Timed Elastic Bands

More information

Design of Driver-Assist Systems Under Probabilistic Safety Specifications Near Stop Signs

Design of Driver-Assist Systems Under Probabilistic Safety Specifications Near Stop Signs Design of Driver-Assist Systems Under Probabilistic Safety Specifications Near Stop Signs The MIT Faculty has made this article openly available. Please share how this access benefits you. Your story matters.

More information

self-driving car technology introduction

self-driving car technology introduction self-driving car technology introduction slide 1 Contents of this presentation 1. Motivation 2. Methods 2.1 road lane detection 2.2 collision avoidance 3. Summary 4. Future work slide 2 Motivation slide

More information

Abnormal Activity Detection and Tracking Namrata Vaswani Dept. of Electrical and Computer Engineering Iowa State University

Abnormal Activity Detection and Tracking Namrata Vaswani Dept. of Electrical and Computer Engineering Iowa State University Abnormal Activity Detection and Tracking Namrata Vaswani Dept. of Electrical and Computer Engineering Iowa State University Abnormal Activity Detection and Tracking 1 The Problem Goal: To track activities

More information

Using Theorem Provers to Guarantee Closed-Loop Properties

Using Theorem Provers to Guarantee Closed-Loop Properties Using Theorem Provers to Guarantee Closed-Loop Properties Nikos Aréchiga Sarah Loos André Platzer Bruce Krogh Carnegie Mellon University April 27, 2012 Aréchiga, Loos, Platzer, Krogh (CMU) Theorem Provers

More information

Modeling Multiple-mode Systems with Predictive State Representations

Modeling Multiple-mode Systems with Predictive State Representations Modeling Multiple-mode Systems with Predictive State Representations Britton Wolfe Computer Science Indiana University-Purdue University Fort Wayne wolfeb@ipfw.edu Michael R. James AI and Robotics Group

More information

Analysis of Forward Collision Warning System. Based on Vehicle-mounted Sensors on. Roads with an Up-Down Road gradient

Analysis of Forward Collision Warning System. Based on Vehicle-mounted Sensors on. Roads with an Up-Down Road gradient Contemporary Engineering Sciences, Vol. 7, 2014, no. 22, 1139-1145 HIKARI Ltd, www.m-hikari.com http://dx.doi.org/10.12988/ces.2014.49142 Analysis of Forward Collision Warning System Based on Vehicle-mounted

More information

Distributed estimation in sensor networks

Distributed estimation in sensor networks in sensor networks A. Benavoli Dpt. di Sistemi e Informatica Università di Firenze, Italy. e-mail: benavoli@dsi.unifi.it Outline 1 An introduction to 2 3 An introduction to An introduction to In recent

More information

Cooperative Motion Control of Multiple Autonomous Marine

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

More information

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

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

Independent Component Analysis and Unsupervised Learning

Independent Component Analysis and Unsupervised Learning Independent Component Analysis and Unsupervised Learning Jen-Tzung Chien National Cheng Kung University TABLE OF CONTENTS 1. Independent Component Analysis 2. Case Study I: Speech Recognition Independent

More information

A Bayesian Perspective on Residential Demand Response Using Smart Meter Data

A Bayesian Perspective on Residential Demand Response Using Smart Meter Data A Bayesian Perspective on Residential Demand Response Using Smart Meter Data Datong-Paul Zhou, Maximilian Balandat, and Claire Tomlin University of California, Berkeley [datong.zhou, balandat, tomlin]@eecs.berkeley.edu

More information

UAV Navigation: Airborne Inertial SLAM

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

More information

PATTERN RECOGNITION AND MACHINE LEARNING CHAPTER 13: SEQUENTIAL DATA

PATTERN RECOGNITION AND MACHINE LEARNING CHAPTER 13: SEQUENTIAL DATA PATTERN RECOGNITION AND MACHINE LEARNING CHAPTER 13: SEQUENTIAL DATA Contents in latter part Linear Dynamical Systems What is different from HMM? Kalman filter Its strength and limitation Particle Filter

More information

On Motion Models for Target Tracking in Automotive Applications

On Motion Models for Target Tracking in Automotive Applications On Motion Models for Target Tracking in Automotive Applications Markus Bühren and Bin Yang Chair of System Theory and Signal Processing University of Stuttgart, Germany www.lss.uni-stuttgart.de Abstract

More information

Independent Component Analysis and Unsupervised Learning. Jen-Tzung Chien

Independent Component Analysis and Unsupervised Learning. Jen-Tzung Chien Independent Component Analysis and Unsupervised Learning Jen-Tzung Chien TABLE OF CONTENTS 1. Independent Component Analysis 2. Case Study I: Speech Recognition Independent voices Nonparametric likelihood

More information

DESIGN AND MODELING OF ADAPTIVE CRUISE CONTROL SYSTEM USING PETRI NETS WITH FAULT TOLERANCE CAPABILITIES. A Thesis. Submitted to the Faculty

DESIGN AND MODELING OF ADAPTIVE CRUISE CONTROL SYSTEM USING PETRI NETS WITH FAULT TOLERANCE CAPABILITIES. A Thesis. Submitted to the Faculty DESIGN AND MODELING OF ADAPTIVE CRUISE CONTROL SYSTEM USING PETRI NETS WITH FAULT TOLERANCE CAPABILITIES A Thesis Submitted to the Faculty of Purdue University by Nivethitha Amudha Chandramohan In Partial

More information

Linear Dynamical Systems (Kalman filter)

Linear Dynamical Systems (Kalman filter) Linear Dynamical Systems (Kalman filter) (a) Overview of HMMs (b) From HMMs to Linear Dynamical Systems (LDS) 1 Markov Chains with Discrete Random Variables x 1 x 2 x 3 x T Let s assume we have discrete

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

Brief Introduction of Machine Learning Techniques for Content Analysis

Brief Introduction of Machine Learning Techniques for Content Analysis 1 Brief Introduction of Machine Learning Techniques for Content Analysis Wei-Ta Chu 2008/11/20 Outline 2 Overview Gaussian Mixture Model (GMM) Hidden Markov Model (HMM) Support Vector Machine (SVM) Overview

More information

Distributed Data Fusion with Kalman Filters. Simon Julier Computer Science Department University College London

Distributed Data Fusion with Kalman Filters. Simon Julier Computer Science Department University College London Distributed Data Fusion with Kalman Filters Simon Julier Computer Science Department University College London S.Julier@cs.ucl.ac.uk Structure of Talk Motivation Kalman Filters Double Counting Optimal

More information

Partially Observable Markov Decision Processes (POMDPs) Pieter Abbeel UC Berkeley EECS

Partially Observable Markov Decision Processes (POMDPs) Pieter Abbeel UC Berkeley EECS Partially Observable Markov Decision Processes (POMDPs) Pieter Abbeel UC Berkeley EECS Many slides adapted from Jur van den Berg Outline POMDPs Separation Principle / Certainty Equivalence Locally Optimal

More information

OPTIMAL FUSION OF SENSOR DATA FOR DISCRETE KALMAN FILTERING Z. G. FENG, K. L. TEO, N. U. AHMED, Y. ZHAO, AND W. Y. YAN

OPTIMAL FUSION OF SENSOR DATA FOR DISCRETE KALMAN FILTERING Z. G. FENG, K. L. TEO, N. U. AHMED, Y. ZHAO, AND W. Y. YAN Dynamic Systems and Applications 16 (2007) 393-406 OPTIMAL FUSION OF SENSOR DATA FOR DISCRETE KALMAN FILTERING Z. G. FENG, K. L. TEO, N. U. AHMED, Y. ZHAO, AND W. Y. YAN College of Mathematics and Computer

More information

Performance Guarantees for Information Theoretic Active Inference

Performance Guarantees for Information Theoretic Active Inference Performance Guarantees for Information Theoretic Active Inference Jason L. Williams, John W. Fisher III and Alan S. Willsky Laboratory for Information and Decision Systems and Computer Science and Artificial

More information

Master 2 Informatique Probabilistic Learning and Data Analysis

Master 2 Informatique Probabilistic Learning and Data Analysis Master 2 Informatique Probabilistic Learning and Data Analysis Faicel Chamroukhi Maître de Conférences USTV, LSIS UMR CNRS 7296 email: chamroukhi@univ-tln.fr web: chamroukhi.univ-tln.fr 2013/2014 Faicel

More information

Warning Timing, Driver Distraction, and Driver Response to Imminent Rear-End Collisions

Warning Timing, Driver Distraction, and Driver Response to Imminent Rear-End Collisions AEBS/LDWS-06-08 Warning Timing, Driver Distraction, and Driver Response to Imminent Rear-End Collisions review of some research literature referred to in the ITS guidelines for high-priority warnings 1

More information

A Control Matching-based Predictive Approach to String Stable Vehicle Platooning

A Control Matching-based Predictive Approach to String Stable Vehicle Platooning Preprints of the 19th World Congress The International Federation of Automatic Control Cape Town, South Africa. August 24-29, 214 A Control Matching-based Predictive Approach to String Stable Vehicle Platooning

More information

Stochastic Reachable Sets of Interacting Traffic Participants

Stochastic Reachable Sets of Interacting Traffic Participants Stochastic Reachable Sets of Interacting Traffic Participants Matthias lthoff, Olaf Stursberg, and Martin Buss bstract Knowledge about the future development of a certain road traffic situation is indispensable

More information

IEEE TRANSACTIONS ON INTELLIGENT TRANSPORTATION SYSTEMS 1. Qian Wang, Beshah Ayalew, Member, IEEE, and Thomas Weiskircher

IEEE TRANSACTIONS ON INTELLIGENT TRANSPORTATION SYSTEMS 1. Qian Wang, Beshah Ayalew, Member, IEEE, and Thomas Weiskircher IEEE TRANSACTIONS ON INTELLIGENT TRANSPORTATION SYSTEMS 1 Predictive Maneuver Planning for an Autonomous Vehicle in Public Highway Traffic Qian Wang, Beshah Ayalew, Member, IEEE, and Thomas Weiskircher

More information

Prediktivno upravljanje primjenom matematičkog programiranja

Prediktivno upravljanje primjenom matematičkog programiranja Prediktivno upravljanje primjenom matematičkog programiranja Doc. dr. sc. Mato Baotić Fakultet elektrotehnike i računarstva Sveučilište u Zagrebu www.fer.hr/mato.baotic Outline Application Examples PredictiveControl

More information

Parametric Unsupervised Learning Expectation Maximization (EM) Lecture 20.a

Parametric Unsupervised Learning Expectation Maximization (EM) Lecture 20.a Parametric Unsupervised Learning Expectation Maximization (EM) Lecture 20.a Some slides are due to Christopher Bishop Limitations of K-means Hard assignments of data points to clusters small shift of a

More information

Model Predictive Controller of Boost Converter with RLE Load

Model Predictive Controller of Boost Converter with RLE Load Model Predictive Controller of Boost Converter with RLE Load N. Murali K.V.Shriram S.Muthukumar Nizwa College of Vellore Institute of Nizwa College of Technology Technology University Technology Ministry

More information

IN MOST of the the automated highway system (AHS)

IN MOST of the the automated highway system (AHS) 614 IEEE TRANSACTIONS ON CONTROL SYSTEMS TECHNOLOGY, VOL. 5, NO. 6, NOVEMBER 1997 AHS Safe Control Laws for Platoon Leaders Perry Li, Luis Alvarez, and Roberto Horowitz, Member, IEEE Abstract The AHS architecture

More information

EVALUATING SYMMETRIC INFORMATION GAP BETWEEN DYNAMICAL SYSTEMS USING PARTICLE FILTER

EVALUATING SYMMETRIC INFORMATION GAP BETWEEN DYNAMICAL SYSTEMS USING PARTICLE FILTER EVALUATING SYMMETRIC INFORMATION GAP BETWEEN DYNAMICAL SYSTEMS USING PARTICLE FILTER Zhen Zhen 1, Jun Young Lee 2, and Abdus Saboor 3 1 Mingde College, Guizhou University, China zhenz2000@21cn.com 2 Department

More information

Partially Observable Markov Decision Processes (POMDPs)

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

More information

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

Chapter 2 Review of Linear and Nonlinear Controller Designs

Chapter 2 Review of Linear and Nonlinear Controller Designs Chapter 2 Review of Linear and Nonlinear Controller Designs This Chapter reviews several flight controller designs for unmanned rotorcraft. 1 Flight control systems have been proposed and tested on a wide

More information