A Cooperation-Aware Lane Change Method for Autonomous Vehicles
Abstract
Lane change for autonomous vehicles (AVs) is an important but challenging task in complex dynamic traffic environments. Due to difficulties in guarantee safety as well as a high efficiency, AVs are inclined to choose relatively conservative strategies for lane change. To avoid the conservatism, this paper presents a cooperation-aware lane change method utilizing interactions between vehicles. We first propose an interactive trajectory prediction method to explore possible cooperations between an AV and the others. Further, an evaluation is designed to make a decision on lane change, in which safety, efficiency and comfort are taken into consideration. Thereafter, we propose a motion planning algorithm based on model predictive control (MPC), which incorporates AV’s decision and surrounding vehicles’ interactive behaviors into constraints so as to avoid collisions during lane change. Quantitative testing results show that compared with the methods without an interactive prediction, our method enhances driving efficiencies of the AV and other vehicles by 14.8% and 2.6% respectively, which indicates that a proper utilization of vehicle interactions can effectively reduce the conservatism of the AV and promote the cooperation between the AV and others.
Index Terms:
Decision making, motion planning, collision avoidance, autonomous vehicles.I Introduction
Autonomous driving technologies are believed to have potentials to significantly reduce traffic accidents, improve travel efficiencies, and enhance comforts of drivers and passengers [1, 2]. To this end, AVs should have abilities to complete different tasks, such as cruise, lane change, etc. Lane change therein is regarded as one of the most dangerous tasks, due to interactions with surrounding vehicles, and causes many traffic accidents. However, lane change would benefit to greatly save travelling times and ensure safety, when it is performed at a right time and in a proper way. In order to enhance the performance of autonomous driving, many studies focus on decision making and motion planning associated with lane change.
In the aspect of decision making on lane change, rule-based approaches were widely used in previous works since they are clear in logic and with low computational costs. For example, Wei et al. [3] proposed a decision making framework to determine a target lane and an acceleration, where a distance-keeping model predicts other vehicles’ trajectories and a cost function was designed for selection of the best decision. Moridpour et al. [4] proposed a fuzzy logic model for decision in lane change, in which a fuzzy rule set was defined to explain decision making processes. However, rule-based methods lack flexibility and only handle limited scenarios because of the difficulty in the logic design for complex or unknown scenarios. In addition, it is difficult for rule-based methods to handle uncertainties. To outperform it, Markov decision process (MDP) [5, 6, 7] has been studied to provide robust lane change decisions. However, it is generally difficult to solve MDP in real time due to its high computational complexity [8].
In recent years, with the development of machine learning, learning-based methods provide a new avenue for lane change decisions. Machine learning models not only can deal with uncertainties due to their probabilistic reasoning, but also can learn nonlinear mapping relations from real-world data to decisions, such that they improve the robustness of decisions. In this way, learning-based methods can make human-like decisions. For example, Hou et al. [9] developed a lane-change-assisted framework, which combines a decision tree and a Bayes classifier to predict whether other drivers decide to merge. Gu et al. [10] used a deep autoencoder network to identify driving behaviors and a XGBoost model to decide whether to change lanes. Other learning-based approaches were also proposed for lane change decisions including support vector machine [11, 12], deep neural network [13, 14, 15] and reinforcement learning [16, 17, 18]. However, due to the lack of interpretability on machine learning algorithms, it is difficult to find the reason of a failure decision under some scenarios.
On the other hand, to complete lane change, an AV with a decision needs to plan a proper trajectory that satisfies specific constraints, e.g., vehicle dynamics, collision avoidance, and available times. In the existing works, motion planning methods can be generally classified into four categories: graph search, interpolating curve, sampling, and numerical optimization [19]. The commonly used graph-search-based methods include algorithm [20], field algorithm [21], Dijkstra algorithm [22], and hybrid algorithm [23]. However, these methods rarely consider constraints of vehicle kinematics, so the generated paths are usually difficult to track. In addition, interpolating-curve-based approaches are usually efficient in computation, such as polynomial curves [24, 25], Bezier curves [26, 27], Dubins curves [28], and Clothoids curves [29]. Nevertheless, these curves are sequences of positions without considering the variation of positions over time, so they cannot guarantee to avoid collisions. Moreover, sampling-based methods sample a configuration space and select samples satisfying predefined requirements as results. Many sampling-based methods were developed based on rapidly-exploring random trees (RRT), since it can deal with general dynamic models [30, 31, 32]. However, their results would be unstable. Finally, numerical-optimization-based approaches obtain an optimal trajectory by minimizing an objective function subject to a set of constraints [33, 34]. This kind of method can comprehensively incorporate various objectives and constraints in trajectory planning.
Although the above approaches have made great progresses in improving AVs’ capacities to execute lane change, there are still limitations. Firstly, these methods take the decision making and trajectory planning for lane change as two separate problems. However, they are actually highly interdependent, so the separation of them would lead to inconsistency between each other. For instance, if the mechanical and physical limits of vehicle motions are not considered by decision making, the motion planning module may fail to find a feasible solution. Secondly, potential cooperations between an AV and other vehicles have not been fully explored, resulting in conservative behaviors of AVs in some complex scenarios. As a specific example, in dense traffic, an AV would not change lanes if it cannot cooperate with others.
Therefore, to overcome the above limitations and improve the safety and efficiency of AVs, this paper presents a cooperation-aware method for determining a proper time instant and a maneuver in lane change, which takes interactions among vehicles into account. Instead of separately designing the modules of decision making and motion planning, we consider these two modules in a unified framework. In detail, we first construct a decision set, in which each decision is generated by a positive and negative trapezoidal lateral acceleration (PNTLA) method. Here, the PNTLA utilizes mechanical and physical limits of vehicle motions, so the feasibility of motion planning is considered during decision making. In addition, we propose an interactive trajectory prediction method to predict surrounding vehicles’ reactions to each decision, which allows to explore possible cooperations. Based on these predictions, an optimal decision is selected by considering safeties, efficiencies and comforts. Subsequently, an MPC-based motion planning algorithm is proposed to solve a trajectory for lane change. Here, we incorporate the prediction of interactive trajectories into constraints to effectively use vehicular interactions to plan a safe trajectory. The contributions of this paper are two folds.
(1) Different from existing works, we propose a complete lane change method, which considers the correlation between decision making and trajectory planning to enhance efficiencies for lane change and prevent conflicts between them. In this way, this method avoids the situations that the planning module fails to generate a trajectory due to an improper decision, and thus guarantees a smooth driving.
(2) Compared with existing methods, we propose an interactive trajectory prediction method, which helps an AV make proactive decisions and avoid being shortsighted. The comparison with other methods demonstrates that it improves driving efficiencies of the AV and others by 14.8% and 2.6%, demonstrating that the AV can use interactions to cooperate with others, and thus to achieve an efficient driving.
The rest of this paper is organized as follows. The problem description is given in Section II. Our system structure is described in Section III. We present a detailed description of the lane change decision module in Section IV. The lane change trajectory planning module is introduced in Section V. Experimental results and analysis are shown in Section VI. Finally, Section VII concludes this paper.
II Problem description of lane change
Lane change is a key maneuver for autonomous driving, which can help an AV secure a higher driving efficiency and safety. In this paper, we consider that only one vehicle is controlled by our proposed lane change method, referred as “ego vehicle”, and all vehicles are not connected through vehicle-to-vehicle or vehicle-to-infrastructure. All vehicles are passenger cars with similar shapes and motion patterns; motorcycles, buses or heavy trucks are not considered. Since a lane change is not recommended near intersections or traffic signals, we assume that the road remains straight along a lane change.
Lane change is executed in the form of a trajectory, which is a function of time mapping time to the state of a vehicle. Hence, we define a trajectory of an ego vehicle as . For the convenience of trajectory planning, the resulting state is denoted as,
(1) |
where and denote longitudinal and lateral positions of a vehicle, respectively, represents the heading angle, and denotes the velocity. Here, note that these four components are studied for lane change and thus we have . When a vehicle runs on a road, the drivable areas impose boundaries on and . Besides, and are limited by the motion capacity of a vehicle.
When the ego vehicle runs on a road with at least two lanes, we assume that it observes perfect trajectories of vehicles around it without any noise or delay. Since the collected data is processed in a digital way, trajectories are discretized with a sampling period . The discrete trajectory is denoted as . With an observation horizon , the observed trajectory of the th vehicle is denoted as,
(2) |
where the subscript indicates the trajectory of the th vehicle, , is the state of the th vehicle at the time step . Similarly, the trajectory of the ego vehicle over is denoted as,
(3) |
After the observation is obtained, the ego vehicle selects an optimal decision on lane change from a decision set . The decision set consists of candidate decisions, which is denoted as . Each decision corresponds to a reference trajectory, denoted as,
(4) |
with a duration , where the subscript denotes the index of a decision, , is the state of the th decision at the time step . The optimal decision on lane change is denoted as . Based on , the ego vehicle adjusts its acceleration and steering angle to plan a trajectory over a planning horizon , which is represented as,
(5) |
where .
Thus, the problem of lane change is summarized as follows. Given observed trajectories of the ego vehicle and its surrounding vehicles, i.e., and , the ego vehicle selects an optimal decision from a decision set , and finally plans a trajectory by adjusting its acceleration and steering angle.
III Structure of proposed cooperation-aware lane change method
As mentioned before, most studies on lane change treat decision making and trajectory planning as two separate problems. The decision making module provides high-level orders, such as accelerating/decelerating, left/right lane change, to low-level modules. The trajectory planning module receives these orders and then solves a feasible trajectory. Although decision making and trajectory planning are hierarchical in term of modules, they are actually highly coupled for successful executions [35, 36]. Therefore, the separate design of the decision making and trajectory planning causes that an improper decision from the decision making module is sent to the trajectory planning module, which might fail to generate a feasible trajectory.
To solve the above problem, we propose a cooperation-aware lane change method, which considers the correlation between the decision making and trajectory planning. The structure of the proposed method is shown in Fig. 1. We can see that the two modules are interdependent. The planning module first sends limits of vehicle motions to the decision module, so that the feasibility of trajectory planning can be considered in decision making. Then, the decision module provides a reference trajectory for the planning module, which uses it to generate a planned trajectory.
The main aim of the decision module is to determine an appropriate time and a proper speed to change lanes while considering the limits of vehicle motions. We first generate various reference trajectory candidates, which consider the feasibility of trajectory planning, to construct a decision set . An interactive trajectory prediction method is then proposed to explore which reference trajectory candidate would potentially promote cooperations between the ego vehicle and surrounding vehicles. Finally, an optimal decision is selected from based on the interactive trajectory prediction while considering safety, driving efficiency and comfort.
The role of the trajectory planning module is to generate a dynamically feasible, collision-free and smooth trajectory based on . The optimal decision poses constraints for the trajectory planning. We formulate the trajectory planning as an optimization problem, which takes model predictive control (MPC) as the basis, since MPC can comprehensively consider the objective function and various constraints, including vehicle dynamics, safety, smooth control actions, ect. By solving this optimization problem, a qualified trajectory is planned.
IV Lane change decision based on interactive trajectory prediction
In this section, we introduce details about the decision module for lane change in the left side of Fig. 1, including the construction of decision set, interactive trajectory prediction, and candidate evaluation.
IV-A Construction of a decision set
The decision set consists of various candidate decisions. Each decision is a reference trajectory, which is an initialization for the subsequent interactive prediction and trajectory planning. For the computational convenience, we set the duration of each reference trajectory to be equal to . In this paper, we limit our discussion on combining three lateral actions (left lane change, right lane change and staying in the current lane) and three longitudinal options (accelerating, decelerating, and keeping in the current speed range) in Fig. 2 to construct . Note that can be extended to contain more decisions according to a practical demand.
In order to generate each , we first calculate the lateral and the longitudinal accelerations. Inspired by the work in [37], we use the PNTLA method to generate a continuous-time lateral reference trajectory. This method can calculate the smooth trajectory with curvature continuity based on the maximum lateral acceleration and the maximum lateral jerk . As shown in Fig. 3, the PNTLA method assumes that when vehicles change lanes, the lateral acceleration varies linearly, and the acceleration curve is composed of two isosceles trapezoids with the same size but opposite directions. Hence, the lateral jerk is expressed as,
(6) |
where to are five key timestamps. Based on the properties of isosceles trapezoids, they are calculated as [37],
(7) |
where denotes the lateral displacement during a lane change. With the timestamps to , the lateral acceleration curve can be determined.
The longitudinal reference trajectory is generated in a similar manner. The longitudinal acceleration curve is described as an isosceles trapezoid which guarantees the smoothness and curvature continuity of a generated trajectory. The longitudinal jerk is expressed as,
(8) |
where denotes a maximum longitudinal jerk, to are three key timestamps. Based on the properties of isosceles trapezoids, to are calculated as,
(9) |
where denotes a maximum longitudinal acceleration, is the current speed, is the desired speed. Similarly, with the timestamps to , the longitudinal acceleration curve is established.
After obtaining the lateral and longitudinal acceleration curves, we can calculate a continuous-time velocity profile by integrating the acceleration curves, and then calculate a continuous-time position profile by integrating the acceleration curves twice. Since the reference trajectory does not consider the vehicle dynamics, the heading angle is set to be equal to the angle between the direction of velocity and the longitudinal axis. Therefore, we obtain a continuous-time trajectory, which should be discretized with to obtain each .
IV-B Interactive trajectory prediction of surrounding vehicles
To select a as an optimal decision for the ego vehicle, it is crucial to predict how surrounding vehicles will react to each . However, due to the strong spatial-temporal dependencies among vehicles, predicting their trajectories is challenging. In this paper, we propose an interactive trajectory prediction method based on the graph-based spatial-temporal convolutional network (GSTCN) [38] to tackle this task, since this network can effectively capture the spatial-temporal dependencies among vehicles and then predict their future trajectories simultaneously. As shown in Fig. 4, GSTCN is composed of three modules: a spatial graph convolutional module, a temporal dependency extractor module, and a trajectory prediction module. The first module uses a graph convolution network to extract the spatial dependencies between vehicles. The following temporal dependency extractor module learns the temporal dependencies. The trajectory prediction module consists of an encoder and a decoder, where both of them are composed of the gated recurrent unit (GRU) networks to deal with the trajectory sequence generation. More details of the GSTCN can be found in [38]. Here, the proposed interactive trajectory prediction method will be introduced in detail from two stages: training step and prediction step.
IV-B1 Training step
GSTCN takes the observed trajectories of all vehicles over an observation horizon as inputs and predicts their future coordinates simultaneously. GSTCN assumes future positions of vehicles are random variables satisfying bi-variable Gaussian distributions, so this network is trained by minimizing a negative log-likelihood loss. The training step is done offline.
IV-B2 Prediction step
After the training is done, we use GSTCN to predict surrounding vehicles’ trajectories for each . For a new observation of the positions of surrounding vehicles at the current moment, GSTCN first predicts their positions at the next time step. Then, we use this prediction to update their current positions. Similarly, the current position of the ego vehicle is updated by . This process will be repeated until is used up. In this way, we obtain the future trajectory of each surrounding vehicle to each over a planning horizon .
To formalize, the proposed interactive trajectory prediction method is denoted as a function that maps , , and to predicted interactive trajectories .
IV-C Candidate evaluation method
After obtaining the predicted interactive trajectories under every , we should determine which is the most recommended in terms of safety, efficiency and comfort [39, 35]. We evaluate each by calculating their costs. The cost function consists of three components and is calculated as
(10) |
where , , and are the costs of safety, efficiency and comfort, respectively. , , and represent the corresponding weights, which can be customized by the user.
The safety cost is related to the collision risks between the ego vehicle and nearby vehicles, which consists of risks in both lateral and longitudinal directions. Therefore, the safety cost is represented as,
(11) |
where and represent the safety costs in longitudinal and lateral directions, respectively. if the ego vehicle changes to other lanes, otherwise , which guarantees that if the does not relate to lane change, the lateral risks can be ignored.
The longitudinal safety cost relates to the collision risks between the ego vehicle and the preceding and following vehicles in the same lane. In this paper, we use the time-to-collision (TTC) [40] to characterize the collision risks, which is calculated based on the relative distances and velocities against the ego vehicle and the preceding and following vehicles in the same lane. The smaller TTC is, the larger the collision risk is. Thus, we define as,
(12) |
with
(13) |
where obtained from is the velocity of the ego vehicle at the time step . The subscripts and represent the indices of the nearest preceding and following vehicles in the same lane, respectively. is the velocity of the nearest preceding vehicle in the same lane at the time step , which is obtained from . denotes the position of a vehicle, and is the norm. Hence, and denote the relative velocity and distance between the ego vehicle and the nearest preceding vehicle in the same lane at the time step . and denote the relative velocity and distance between the ego vehicle and the nearest following vehicle in the same lane. is the regularization coefficient of the longitudinal safety cost, which is determined by practical demands. , which guarantees that two vehicles moving away from each other will not contribute a safety cost.
Similarly, the lateral safety cost is calculated based on the relative distances and velocities against the ego vehicle and the preceding and following vehicles in the target lane, which is defined as,
(14) |
where is the regularization coefficient of the lateral safety cost. The subscripts and represent the indices of the nearest preceding and following vehicles in the target lane, respectively.
Moreover, the efficiency cost is related to the velocities of the ego vehicle and surrounding vehicles. The closer their speeds are to the desired speed, the smaller the efficiency cost is. Hence, is defined as,
(15) |
where is the regularization coefficient of the efficiency cost, is the desirable velocity, and are the velocities of the th nearby vehicle and the ego vehicle, respectively. Since we want to make decisions that can help the ego vehicle to cooperate with others, the efficiency cost indicates that both the ego vehicle and surrounding vehicles want to reach the desirable speeds.
In addition, the comfort cost aims to make the ego vehicle travel with a relatively smooth trajectory, so it relates to the jerk in both lateral and longitudinal directions. is defined as,
(16) |
where and are regularization coefficients of the comfort cost. and denote the longitudinal and lateral jerks of the ego vehicle, which can be obtained by calculating the derivative of acceleration with respect to time from .
After the cost function is defined, we select a with the minimal cost as the optimal decision , which makes a balance among safety, efficiency, and comfort.
Note that in the process of generating the reference trajectory candidates, we utilize the lateral displacement, the maximum lateral acceleration, the maximum lateral jerk, the maximum longitudinal acceleration, and the maximum longitudinal jerk. Therefore, the feasibility of a motion planning has been considered during the phase of the lane change decision.
V Model-predictive-control-based trajectory planning for lane change
In this section, based on the above optimal reference trajectory and the corresponding interactive trajectory prediction , we introduce the trajectory planning for a lane change. We formulate the trajectory planning as a model predictive control (MPC)-based optimization problem. MPC can effectively handle optimization problems with constraints while respecting vehicle dynamics. Next, we will introduce a predictive model, constraints, an objective function, and the Ipopt-based approach for trajectory planning.
V-A Kinematics-based predictive model
To realize the trajectory planning for the ego vehicle, we first establish a mathematical model of vehicle kinematics. The more accurately the model describes the motions of a vehicle, the more accurately the planned trajectory will be tracked by a control system. However, due to the limited computing resources and high requirements for computing time in driving environments, the vehicle kinematics model should also have the advantages of easy implementation and low computation complexity. To this end, we use the bicycle model in [41] to describe the nonlinear vehicle kinematics. With the Euler discretization, this vehicle kinematic model can be defined as,
(17) |
where denotes the angle between the speed and the heading, and denote the length from the gravity center of a vehicle to the front axle and the rear axle, respectively, is the acceleration, and denotes the steering angle. Thus, we obtain a predictive model for MPC. As mentioned in Section II, the acceleration and the steering angle are taken as control actions, and thus we define them as .
V-B Mechanical and physical constraints
Due to the mechanical and physical limitations in velocity, heading angle, and position, we need to take the boundaries of these variables as constraints in the process of motion planning to achieve a feasible solution. Specifically, they are represented as,
(18) |
where the first constraint considers the road boundaries and the available range of the heading angle and the velocity, i.e., and ; the second constraint ensures the acceleration and the steering angle do not exceed the vehicle’s capacity from to ; the last constraint guarantees the smoothness and comfort of generated trajectories by restraining the control input rate to a range from to .
V-C Safety constraints
In addition to the above mechanical and physical constraints, we also consider the safety constraints. Since the vehicle-occupied road area imposes restrictions on the movements of other vehicles, it is essential to model a precise vehicle shape. Unlike previous works that model the shape of vehicles as a mass point or particles with radial gaps, we assume vehicles are rectangular which is closer to an actual circumstance. As shown in Fig. 5, the vehicle-occupied road region is represented by a rectangle , which is expressed as,
(19) |
As in [42], the matrix and the vector are expressed as,
(20) | ||||
with the length and width of a vehicle, and the current coordinate of the gravity center .
With this vehicle shape model, the distance between two vehicles can be represented as,
(21) |
where and are the road regions occupied by two vehicles, respectively, and and denote any coordinates in the occupied road regions. Therefore, the safety constraints is represented as,
(22) |
where and denote the road regions occupied the ego vehicle and the th nearby vehicle at the time step , respectively, is the minimum safety distance between vehicles. With the interactive trajectory prediction of nearby vehicles , we can calculate their occupied regions in the planning time horizon. In this way, vehicular interactions are considered during trajectory planning.
Note that the collision avoidance constraint (22) is nondifferentiable, so we adopt the approach in [43] to convert this constraint to a smooth and differentiable constraint by using strong duality theory. Based on this method, the safety constraints (22) can be reformulated as,
(23) |
where , and are the dual variables. Interested readers are referred to [43] for more details. With this exact and smooth reformulation, standard nonlinear solvers can deal with the safety constraints.
V-D Objective function and overall optimization formulation for planning
The objective is to minimize the deviation between the trajectory updated by the vehicle kinematic model and the reference trajectory associated with the optimal decision; meanwhile, smooth control actions are preferred for comfort. This objective function is defined as follows,
(24) |
where represents the state at the time step predicted by the state at the time step , is the length of optimization horizon under the sampling period , , and denote the corresponding weight matrices. The first term of the objective function penalizes the divergence of the solved trajectory from the reference trajectory. The second and third term suppress the excessive control actions and control input rates, respectively.
With the objective function and constraints introduced in the above subsections, the trajectory planning is formulated as an optimization problem, i.e.,
(25) | ||||
s.t. | ||||
where the first constraint guarantees the initial solved state to be equal to the reference state .
V-E Ipopt-based approach for trajectory planning
To solve the optimization problem (25), we propose an algorithm to plan the trajectory for a lane change based on interior point optimizer (Ipopt) [44]. Ipopt is a widely used numerical solver for large-scale nonlinear optimization problems.
The algorithm for trajectory planning based on Ipopt is described in Algorithm 1. The optimization problem at the time step is established as (25). By solving this problem, a sequence of optimal control actions can be obtained. As the basic MPC algorithm in [45], we only apply the first control action to the ego vehicle to update its state. At the next time step , the horizon moves forward and a new optimization problem is formulated and solved by our algorithm. By repeating this procedure, the ego vehicle can obtain an optimal trajectory that is smooth, collision-free, and satisfies the vehicle kinematic model. Till now we have formulated an optimization and an Ipopt-based algorithm to complete the task of trajectory planning.
VI Simulation Study
In this section, we show the effectiveness and flexibility of the proposed lane change method through simulations in different complex traffic scenarios and comparison with other methods. The effectiveness is further discussed by analyzing the prediction of other vehicles’ interactive trajectories.
VI-A Simulation environment
An open-source automotive driving simulator [46] is used to implement the simulation scenarios. We consider two-lane or three-lane highway. All vehicles have the same shapes; i.e., 4 meters in length and 1.8 meters in width. Only the ego vehicle uses our proposed method for lane change. For other vehicles, the longitudinal motions and lateral lane change behaviors are governed by the Intelligent Driver Model (IDM) [47] and the Minimizing Overall Braking Induced by Lane changes (MOBIL) [48] model, respectively. In order to increase the complexity of the simulated scenarios, the parameters in the IDM and the MOBIL are randomly sampled from uniform distributions. The sampling period is set to be equal to 0.1s.
VI-B Baselines
In order to further demonstrate the superiority of our proposed method, we compare it with the following baselines.
-
•
IDM+MOBIL: This baseline controls the lateral and longitudinal motions with MOBIL and IDM, respectively, which is the same as other vehicles.
-
•
Our proposed method without interactive trajectory prediction (denoted as Proposed W/O IP): This baseline is the same as our proposed method except that it uses constant velocity, instead of the interactive trajectory prediction method in Section IV-B, to predict other vehicles’ trajectories.
VI-C Quantitative analysis
In this subsection, we make quantitative analysis for the proposed method. We totally conduct 100 simulations under different traffic densities. In each simulation, vehicles run on a three-lane highway, and the parameters and initial positions for each vehicle are random. The mean velocities of the ego vehicle and surrounding vehicles are listed in Table I.
We can see that ego vehicles equipped with our proposed method achieve the fastest speeds, demonstrating the effectiveness of interactive trajectory prediction. Meanwhile the mean speed of other vehicles are faster than that of other baselines. This is because the ego vehicle also considers the driving efficiencies of surrounding vehicles when making decisions on lane changes. Therefore, their driving efficiencies will be improved when the ego vehicle cooperates with others. The ego vehicle using IDM+MOBIL only considers the observation at the current time but ignores the prediction of the future, so the mean speeds are the slowest.
Object | IDM+MOBIL | Proposed | Proposed |
W/O IP | |||
Ego vehicle (m/s) | 13.95 | 14.85 | 16.01 |
Ohter vehicles (m/s) | 14.19 | 14.31 | 14.56 |
VI-D Case study


As shown in Fig. 6, we also study two practical cases for lane change, including obstacle avoidance in dense traffic, and complex traffic with three lanes having different speeds and space gaps.
VI-D1 Case 1
In this case, as shown in Fig. 6(a), the ego vehicle drives in dense traffic, and the space gap between any two consecutive vehicles in Lane 1 is insufficient for others to merge into. There is a stationary obstacle in front of the ego vehicle, so the ego vehicle should decide whether to stay in the current lane and stop or change to another lane for normal driving. If the ego vehicle chooses the latter decision for a higher efficiency, it needs the ability to interact with other vehicles to make them yield and make a space for it to cut in.





Fig. 7 shows the visualization of testing results at different time instants. It can be seen that although the initial inter-vehicle distances in Lane 1 are too narrow to merge in, the ego vehicle still successfully changes to that lane. As shown in Fig. 7(b), at the time instant = 2s, the ego vehicle heads to the left and is going to overtake the left vehicle, which slows down to help the ego vehicle cut in. As shown in Fig. 7(c), at the time instant = 3s, the ego vehicle has overtaken the left vehicle and is merging into the target lane. Finally, as shown in Fig. 7(e), the ego vehicle successfully changes to Lane 1 at about 8s.
Fig. 8 illustrates how the ego vehicle achieves interactions with surrounding vehicles by adjusting its acceleration and steering angle. The whole process for lane change can be divided into three stages: before, during, and after merging. Between 13s, it is before the merging. The ego vehicle prepares for lane change by applying positive steering angle to approach the target lane and accelerating to overtake the left vehicle. When the ego vehicle is close enough to the target lane, as shown in Fig. 7(b), the gap in front of the left vehicle is larger than the initial one, demonstrating the left vehicle is slowing down and giving way to the ego vehicle. Between 37.8s, it is the second stage: the ego vehicle frequently adjusts its velocity and heading angle. This is because ego vehicle needs to speed up to overtake the left vehicle to merge into Lane 1, but must slow down to avoid collision whenever it is too close to the preceding vehicle. In the third stage, the ego vehicle has successfully entered the target lane. At this time, the ego vehicle only keeps the lane and does not need to interact with others to seek cooperation, so its acceleration and steering angle gradually tend to zeros.
To demonstrate the superiority of our proposed method, the comparison between our method and the above baselines is shown in Fig. 9. We can see that both baselines choose a relatively conservative strategy. They decide to stay in the current lane, and thus the ego vehicle has to slow down to avoid collision with the obstacle. This is because these baselines cannot utilize the cooperative behaviors of surrounding vehicles to help the ego vehicle change to another lane. As a result, even if a higher speed can be gained by changing lanes, the ego vehicle is not advised to change lanes. In contrast, our proposed method can make the ego vehicle actively interact with other vehicles, and thus the ego vehicle changes to Lane 1 safely to avoid being blocked by the obstacle and keep a high speed.




In order to further investigate how our method determines whether the lane change is a feasible decision, and how to use vehicular interactions to achieve cooperation during trajectory planning, Fig. 10 shows several examples of the interactive trajectory prediction in this case. Our proposed method selects the decision in Fig. 10(a) as the optimal one, since the interactive trajectory prediction indicates that if the ego vehicle runs in this way, the vehicle behind will slow down and enlarge the gap. Therefore, this decision can help the ego vehicle avoid collision with the obstacle and change lanes safely to ensure normal driving. The decision in Fig. 10(b) can also make the ego vehicle overtake the left vehicle and then change lanes, but the prediction shows that the ego vehicle would collide with the front vehicle. This is consistent with the intuition that the front vehicle rarely reacts to the speed of the following vehicle. We can see from Fig. 10(c) and (d) that if the ego vehicle neither changes to another lane nor decelerates, it will collide with obstacles. Based on the above discussion and analysis, we conclude that our proposed method is able to obtain reliable interactive trajectory prediction, which can be further used to determine the most proper decision and provide the motion planning module with safety constraints to avoid collision between vehicles.
VI-D2 Case 2
In this case, a complex traffic scenario is studied. Fig. 6(b) shows the top view snapshot of vehicles at the initial time. The vehicles in Lane 1 have the fastest speeds and narrowest inter-vehicle distances, so it is risky to change to this lane in order to obtain a higher speed. On the contrary, vehicles in Lane 3 have the slowest speeds and largest inter-vehicle distances. The ego vehicle is driving in Lane 2, and vehicles in Lane 2 have moderate speeds. Since the vehicle in front of the ego vehicle travels at a slower speed than vehicles in Lane 1, the ego vehicle needs to decide whether to follow the preceding vehicle and keep a slow speed to guarantee the safety or to change to Lane 1 to gain a higher speed. The decision is dependent on the reaction of surrounding vehicles and whether a feasible trajectory can be generated.






The simulation results at different time instants are presented in Fig. 11. We can see that the ego vehicle makes two lane changes to reach the fastest speed. At first, in order to get rid of the influence of the preceding vehicle with slow speeds, the ego vehicle tries to change to Lane 1 by interacting with other vehicles. As shown in Fig. 11(b), at the time instant = 2s, the left following vehicle slows down to expand the space gap to help the ego vehicle to cut in. As shown in Fig. 11(c), the ego vehicle completes lane change and overtaking at the time instant = 4s. Further, as shown in Fig. 11(f), the ego vehicle returns to Lane 2 and obtains the fastest speed.
These interactive behaviors can also be interpreted by the acceleration and steering angle of the ego vehicle in Fig. 12. Similar to the first case, the process for two lane changes is divided into six stages. Since the initial speed of the ego vehicle is lower than the left vehicle’s, it increases its longitudinal speed while moving towards Lane 1 before the first merging. At about 2 to 4 seconds, the acceleration and steering angle of the ego vehicle fluctuate, which indicates that the ego vehicle wants to switch to the target lane quickly while avoiding collision with the preceding vehicle. Between 46.7s, the control actions are getting closer to zeros since the ego vehicle has finished the first lane change and only needs to drive steadily. At about 7 seconds, as shown in Fig. 11(d), the space gap between the front vehicle and the right one is large enough, and there is no front vehicle in the Lane 2. Consequently, after the prediction and evaluation, our proposed method decides to accelerate and change to Lane 2. Between 89.5s, the ego vehicle smoothly enters the target lane.
As shown in Fig. 13, in the second studied case, the ego vehicle using both baselines exhibits conservative behaviors. For the baseline Proposed W/O IP, we can see that it decides to stay in the current lane and speed. Because of the lack of interactive prediction, this baseline believes there would be a collision when changing to Lane 1. For another baseline, we can see that at about 0.5 seconds, the ego vehicle attempts to switch to Lane 3 where the space gap between vehicles is large. But soon it finds that the speeds of vehicles in this lane are too slow, so it returns to the original lane. This is because this baseline cannot predict the future trajectory of other vehicles. Therefore, when it decides to change to Lane 3, it only considers the benefits of a larger space gap, but cannot predict the future speed loss. The lack of trajectory prediction leads to large amplitudes and frequent actions on the steering wheel, which reduces the driving comfort. After returning to the original lane, the ego vehicle has to follow the preceding vehicle and maintain a relatively slow speed. Similar to the first case, although the speeds of vehicles in Lane 1 are faster, the ego vehicle is not recommended to change that lane because the close distances between vehicles may cause a collision. However, the ego vehicle equipped with our proposed method is more inclined to create a favorable environment through active cooperation with other vehicles, so it can achieve safe, comfortable and efficient driving.









We take the first merging as an example to explore how the proposed method decides to accelerate and change to Lane 1. The interactive trajectory prediction for each decision is shown in Fig. 14, and the cost values are listed in Table II. From the prediction in Fig. 14(f), (h) and (i), we can see that these three decisions would lead to collisions, and thus their cost values for safety are much higher than others’. When the ego vehicle changes to the left lane at low or current speeds, the prediction in Fig. 14(a) and (b) indicate that the left following vehicle will slow down. Despite both decisions are safe, their cost values for efficiency vary greatly, resulting in a large difference in the total costs. Besides, although keeping in the current lane and speed range would not cause any costs for safety and comfort, its efficiency cost contributes to a higher total cost than that of left lane change & accelerating. Therefore, our proposed method selects left lane change & accelerating as the optimal decision. From the results in Fig. 1113, we can see that the planned trajectory is safe and smooth, has low requirements for control actions, and achieves higher driving efficiency, demonstrating it is an appropriate decision.
Decision | Safety | Comfort | Efficiency | Total |
---|---|---|---|---|
cost | ||||
Left lane change | 39.6 | 388.3 | 8094.8 | 8522.7 |
& decelerating | ||||
Left lane change | 23.6 | 262.0 | 5020.4 | 5306.0 |
& speed keeping | ||||
Left lane change | 749.8 | 388.3 | 1633.2 | 2771.3 |
& accelerating | ||||
Lane keeping | 290.0 | 126.3 | 6293.1 | 6709.4 |
& decelerating | ||||
Lane keeping | 0.0 | 0.0 | 3600.0 | 3600.0 |
& speed keeping | ||||
Lane keeping | 8139.0 | 126.3 | 1669.1 | 9934.4 |
& accelerating | ||||
Right lane change | 211.8 | 388.3 | 6094.8 | 6694.9 |
& decelerating | ||||
Right lane change | 7468.0 | 262.0 | 3520.4 | 11250.4 |
& speed keeping | ||||
Right lane change | 3051.3 | 388.3 | 1633.2 | 5072.8 |
& accelerating |
VII Conclusions
In this paper, we have presented a cooperation-aware method that can help the ego vehicle to execute a proper lane change for guarantee driving efficiency and safety. Different from the existing methods, we have considered the interdependence between the lane change decision module and the trajectory planning module so as to avoid possible conflicts between them. An interactive trajectory prediction method has been proposed, with which we have designed a candidate evaluation method. By doing so, our approach can find potential cooperation by predicting others’ interactions so that a less conservative decision on lane change can be made. With a right lane change decision, a safe, efficient, and comfortable driving can be well guaranteed. During the process of planning a lane change trajectory, interactive trajectories has been incorporated into constraints, such that the ego vehicle can interact with others to promote cooperation by adjusting its control inputs. The quantitative results have demonstrated that when using our proposed method, the driving efficiencies of the ego vehicle and others are 14.8% and 2.6% higher than those with methods without interactive prediction. Two practical case studies further analyze how the proposed method predicts interactive trajectories of other vehicles and uses this interactive prediction to make decisions.
Following the stream of this study, several future works can be done. (i) The uncertainty caused by sensor measurement errors and communication delays can be considered to improve the robustness. (ii) The proposed lane change method is only applied on single vehicle to improve driving efficiencies of its nearby vehicles and itself. Based on our method, exploring a distributed framework to optimize a large traffic network is also worthwhile for future research.
References
- [1] B. Paden, M. Čáp, S. Z. Yong, D. Yershov, and E. Frazzoli, “A survey of motion planning and control techniques for self-driving urban vehicles,” IEEE Trans. Intell. Vehicles, vol. 1, no. 1, pp. 33–55, Mar. 2016.
- [2] J. Rios-Torres and A. A. Malikopoulos, “A survey on the coordination of connected and automated vehicles at intersections and merging at highway on-ramps,” IEEE Trans. Intell. Transp. Syst., vol. 18, no. 5, pp. 1066–1077, May 2017.
- [3] J. Wei, J. M. Dolan, and B. Litkouhi, “A prediction-and cost function-based algorithm for robust autonomous freeway driving,” in Proc. IEEE Intell. Vehicles Symp., Jun. 2010, pp. 512–517.
- [4] S. Moridpour, M. Sarvi, G. Rose, and E. Mazloumi, “Lane-changing decision model for heavy vehicle drivers,” J. Intell. Transp. Syst., vol. 16, no. 1, pp. 24–35, 2012.
- [5] S. Ulbrich and M. Maurer, “Probabilistic online POMDP decision making for lane changes in fully automated driving,” in Proc. 16th Int. IEEE Conf. Intell. Transp. Syst., Oct. 2013, pp. 2063–2067.
- [6] S. Coskun and R. Langari, “Predictive fuzzy markov decision strategy for autonomous driving in highways,” in Proc. IEEE Conf. Control Technol. Appl., Aug. 2018, pp. 1032–1039.
- [7] V. Sezer, “Intelligent decision making for overtaking maneuver using mixed observable markov decision process,” J. Intell. Transp. Syst., vol. 22, no. 3, pp. 201–217, 2018.
- [8] W. Schwarting, J. Alonso-Mora, and D. Rus, “Planning and decision-making for autonomous vehicles,” Annu. Rev. Control, Robot., Auto. Syst., vol. 1, no. 1, pp. 187–210, May 2018.
- [9] Y. Hou, P. Edara, and C. Sun, “Modeling mandatory lane changing using bayes classifier and decision trees,” IEEE Trans. Intell. Transp. Syst., vol. 15, no. 2, pp. 647–655, Apr. 2014.
- [10] X. Gu, Y. Han, and J. Yu, “A novel lane-changing decision model for autonomous vehicles based on deep autoencoder network and XGBoost,” IEEE Access, vol. 8, pp. 9846–9863, Jan. 2020.
- [11] J. Zhang, Y. Liao, S. Wang, and J. Han, “Study on driving decision-making mechanism of autonomous vehicle based on an optimized support vector machine regression,” Appl. Sci., vol. 8, no. 1, p. 13, Dec. 2018.
- [12] Y. Liu, X. Wang, L. Li, S. Cheng, and Z. Chen, “A novel lane change decision-making model of autonomous vehicle based on support vector machine,” IEEE Access, vol. 7, pp. 26 543–26 550, Feb. 2019.
- [13] J. Zheng, K. Suzuki, and M. Fujita, “Predicting driver’s lane-changing decisions using a neural network model,” Simul. Model. Pract. Theory, vol. 42, pp. 73–83, Mar. 2014.
- [14] O. Costilla-Reyes, P. Scully, and K. B. Ozanyan, “Deep neural networks for learning spatio-temporal features from tomography sensors,” IEEE Trans. Ind. Electron., vol. 65, no. 1, pp. 645–653, Jan. 2018.
- [15] L. Li, K. Ota, and M. Dong, “Humanlike driving: Empirical decision-making system for autonomous vehicles,” IEEE Trans. Veh. Technol., vol. 67, no. 8, pp. 6814–6823, Aug. 2018.
- [16] D. C. K. Ngai and N. H. C. Yung, “A multiple-goal reinforcement learning method for complex vehicle overtaking maneuvers,” IEEE Trans. Intell. Transp. Syst., vol. 12, no. 2, pp. 509–522, Jun. 2011.
- [17] X. Xu, L. Zuo, X. Li, L. Qian, J. Ren, and Z. Sun, “A reinforcement learning approach to autonomous decision making of intelligent vehicles on highways,” IEEE Trans. Syst., Man, Cybern. Syst., vol. 50, no. 10, pp. 3884–3897, 2020.
- [18] C. You, J. Lu, D. Filev, and P. Tsiotras, “Highway traffic modeling and decision making for autonomous vehicle using reinforcement learning,” in Proc. IEEE Intell. Vehicles Symp. IEEE, Jun. 2018, pp. 1227–1232.
- [19] D. González, J. Pérez, V. Milanés, and F. Nashashibi, “A review of motion planning techniques for automated vehicles,” IEEE Trans. Intell. Transp. Syst., vol. 17, no. 4, pp. 1135–1145, Apr. 2016.
- [20] A. Stentz, “Optimal and efficient path planning for partially known environments,” in Proc. IEEE Int. Conf. Robot. Autom., May 1994, pp. 3310–3317.
- [21] D. Ferguson and A. Stentz, “Using interpolation to improve path planning: The field D* algorithm,” J. Field Robot., vol. 23, no. 2, pp. 79–101, 2006.
- [22] L. Parungao, F. Hein, and W. Lim, “Dijkstra algorithm based intelligent path planning with topological map and wireless communication,” ARPN J. Eng. Appl. Sci., vol. 13, no. 8, pp. 2753–2763, 2018.
- [23] D. Fassbender, A. Mueller, and H.-J. Wuensche, “Trajectory planning for car-like robots in unknown, unstructured environments,” in Proc. IEEE/RSJ Int. Conf. Intell. Robots Syst., Sept. 2014, pp. 3630–3635.
- [24] Y. Guan, K. Yokoi, O. Stasse, and A. Kheddar, “On robotic trajectory planning using polynomial interpolations,” in Proc. IEEE Int. Conf. Robot. Biomimetics, Jul. 2005, pp. 111–116.
- [25] X. He, D. Xu, H. Zhao, M. Moze, F. Aioun, and F. Guillemard, “A human-like trajectory planning method by learning from naturalistic driving data,” in Proc. IEEE Intell. Vehicles Symp., Jun. 2018, pp. 339–346.
- [26] L. Han, H. Yashiro, H. T. N. Nejad, Q. H. Do, and S. Mita, “Bezier curve based path planning for autonomous vehicle in urban environment,” in Proc. IEEE Intell. Vehicles Symp., Jun. 2010, pp. 1036–1042.
- [27] X. Qian, I. Navarro, A. de La Fortelle, and F. Moutarde, “Motion planning for urban autonomous driving using bézier curves and MPC,” in Proc. IEEE 19th Int. Conf. Intell. Transp. Syst., Nov. 2016, pp. 826–833.
- [28] D. Yang, D. Li, and H. Sun, “2D Dubins path in environments with obstacle,” Math. Problems Eng., vol. 2013, pp. 1–6, Nov. 2013.
- [29] E. Bertolazzi, P. Bevilacqua, F. Biral, D. Fontanelli, M. Frego, and L. Palopoli, “Efficient re-planning for robotic cars,” in Proc. Eur. Control Conf., Jun. 2018, pp. 1068–1073.
- [30] J. J. Kuffner and S. M. LaValle, “RRT-connect: An efficient approach to single-query path planning,” in Proc. IEEE Int. Conf. Robot. Autom., vol. 2, Apr. 2000, pp. 995–1001.
- [31] N. A. Melchior and R. Simmons, “Particle RRT for path planning with uncertainty,” in Proc. IEEE Int. Conf. Robot. Autom., Apr. 2007, pp. 1617–1624.
- [32] M. Kothari and I. Postlethwaite, “A probabilistically robust path planning algorithm for uavs using rapidly-exploring random trees,” J. Intell. Robot. Syst., vol. 71, no. 2, pp. 231–253, Aug. 2013.
- [33] J. Ziegler, P. Bender, M. Schreiber, H. Lategahn, T. Strauss, C. Stiller, T. Dang, U. Franke, N. Appenrodt, C. G. Keller et al., “Making bertha drive—an autonomous journey on a historic route,” IEEE Intell. Transp. Syst. Mag., vol. 6, no. 2, pp. 8–20, Summer 2014.
- [34] W. Xu, J. Wei, J. M. Dolan, H. Zhao, and H. Zha, “A real-time motion planner with trajectory optimization for autonomous vehicles,” in Proc. IEEE Int. Conf. Robot. Autom., May 2012, pp. 2061–2067.
- [35] P. Hang, C. Lv, C. Huang, J. Cai, Z. Hu, and Y. Xing, “An integrated framework of decision making and motion planning for autonomous vehicles considering social behaviors,” IEEE Trans. Veh. Technol., vol. 69, no. 12, pp. 14 458–14 469, Dec. 2020.
- [36] Y. Lu, X. Xu, X. Zhang, L. Qian, and X. Zhou, “Hierarchical reinforcement learning for autonomous decision making and motion planning of intelligent vehicles,” IEEE Access, vol. 8, pp. 209 776–209 789, Oct. 2020.
- [37] L. Guo, P. S. Ge, M. Yue, and Y. B. Zhao, “Lane changing trajectory planning and tracking controller design for intelligent vehicle running on curved road,” ” Math. Probl. Eng., vol. 2014, pp. 1–9, Jan. 2014.
- [38] Z. Sheng, Y. Xu, S. Xue, and D. Li, “Graph-based spatial-temporal convolutional network for vehicle trajectory prediction in autonomous driving,” arXiv preprint arXiv:2109.12764, 2021.
- [39] P. Hang, C. Lv, Y. Xing, C. Huang, and Z. Hu, “Human-like decision making for autonomous driving: A noncooperative game theoretic approach,” IEEE Trans. Intell. Transp. Syst., pp. 1–12, 2020.
- [40] J. C. Hayward, “Near miss determination through use of a scale of danger,” 1972.
- [41] J. Kong, M. Pfeiffer, G. Schildbach, and F. Borrelli, “Kinematic and dynamic vehicle models for autonomous driving control design,” in Proc. IEEE Intell. Vehicles Symp., Jun. 2015, pp. 1094–1099.
- [42] R. Firoozi, X. Zhang, and F. Borrelli, “Formation and reconfiguration of tight multi-lane platoons,” Control Eng. Pract., vol. 108, p. 104714, Mar. 2021.
- [43] X. Zhang, A. Liniger, and F. Borrelli, “Optimization-based collision avoidance,” IEEE Trans. Control Syst. Technol., vol. 29, no. 3, pp. 972–983, May 2021.
- [44] A. Wächter and L. T. Biegler, “On the implementation of an interior-point filter line-search algorithm for large-scale nonlinear programming,” Math. program., vol. 106, no. 1, pp. 25–57, Mar. 2006.
- [45] E. F. Camacho and C. B. Alba, Model Predictive Control. Springer, 2013.
- [46] Stanford Intelligent Systems Laboratory, Automotivedrivingmodels.jl, https://github.com/sisl/ AutomotiveDrivingModels.jl.
- [47] M. Treiber, A. Hennecke, and D. Helbing, “Congested traffic states in empirical observations and microscopic simulations,” Phys. Rev. E, vol. 62, no. 2, pp. 1805–1824, Aug. 2000.
- [48] A. Kesting, M. Treiber, and D. Helbing, “General lane-changing model MOBIL for car-following models,” Transp. Res. Rec., vol. 1999, no. 1, pp. 86–94, 2007.