Skip to main content

Planning and Decision-making for Connected Autonomous Vehicles at Road Intersections: A Review

Abstract

Planning and decision-making technology at intersections is a comprehensive research problem in intelligent transportation systems due to the uncertainties caused by a variety of traffic participants. As wireless communication advances, vehicle infrastructure integrated algorithms designed for intersection planning and decision-making have received increasing attention. In this paper, the recent studies on the planning and decision-making technologies at intersections are primarily overviewed. The general planning and decision-making approaches are presented, which include graph-based approach, prediction base approach, optimization-based approach and machine learning based approach. Since connected autonomous vehicles (CAVs) is the future direction for the automated driving area, we summarized the evolving planning and decision-making methods based on vehicle infrastructure cooperative technologies. Both four-way signalized and unsignalized intersection(s) are investigated under purely automated driving traffic and mixed traffic. The study benefit from current strategies, protocols, and simulation tools to help researchers identify the presented approaches’ challenges and determine the research gaps, and several remaining possible research problems that need to be solved in the future.

1 Introduction

Over the past decades, there are assive amounts of investments that have een put into elieving the traffic congestion problem around the world. However, road traffic congestion is still one of the major concerns of travelers. It is found that congestion can inflict high economic costs [1]. The cost in the United States is up to $124.2 billion in 2013 and is expected to increase to $186.2 billion in 2030 with traffic congestion forecast to increase by 60% [2]. In this paper, the study focused on addressing the methods of planning and decision-making methods at intersections. We believe that intersections could be one of the most critical traffic environments from the perspective of safety and mobility [3,4,5,6,7].

From the previous research works, intersections are important parts of traffic networks. The commonly used approach to manage the intersection is traffic signals control. However, the efficiency of the traditional traffic lights is relatively low when traffic volumes are high [8]. Currently, over 30,0000 traffic lights among the U.S. with 82.7 billion investments [9]. It is necessarily to operate the traffic signal efficiently to reduce the congestion and improvement the mobility at intersections. However, the majority of signals in the U.S. are pre-timed and updated every 2‒5 years. The re-timing traffic signals has huge benefits. Ref. [10] discussed how this type of traffic engineering maintenance can significantly reduce delays and stops experienced by automobile drivers. The results showed that the benefit to cost ratio for signal re-timing is approximately 40:1.

Moreover, researchers found that most incidents occurred in intersections and caused significant traffic delays in urban area [4]. From reports published by National Highway Traffic Safety Administration (NHTSA), intersection crashes are among the most serious crash modes in the U.S. In 2015, crashes in intersections accounted for 1.3 million police-reported crashes and 5251 fatal crashes [11, 12]. These crashes correspond to approximately 20% of all police reported crashes and 16% of all fatal crashes [13]. Therefore, it is important to develop technologies at intersections to allow vehicles to pass the intersection safely and efficiently.

With the autonomous vehicle technology and the wireless communication technology development, the field of the autonomous intersection management (AIM) system has attracted a lot of attention and shows lots of research and development efforts. AIM can coordinate the movement of autonomous vehicles through intersections. A typical complete AIM system is shown as Figure 1. There are several important components of the system: Vehicle on board unit (OBU), Roadside unit (RSU), Signal Controller, Traffic control unit (TCU), Traffic control center (TCC), Traffic operation center (TOC), and Cloud. For planning and decision-making purpose, the OBU should contain vehicle dynamic control and intersection approach/departure applications in intersection segment, the RSU should provide vehicle lane group control, vehicle driving reservation and planning to help vehicles cross the intersection. The signal controller helps control the traffic signal based on the data received. TCU/TCC/TOC will coordinate to determine and execute the optimal intersection passing movement. The Cloud system could interact with other Ur ban Services/Applications. However, if we want autonomous vehicles to operate at intersection with high efficiency and safety, we must design an appropriate way to coordinate them carefully [14, 15]. Previously, intersection management research separated into two branches, i.e., cooperative resource reservation and trajectory planning [16]. In cooperative resource reservation, the intersection space is separated into the time-space sequence that is assigned to vehicles and scheduled to achieve a safe crossing. The reservations can be managed by a centralized unit [17, 18] or in a distributed manner [19, 20]. As for trajectory-planning approaches, researchers focused on the movement of vehicles relative to a fixed point in the intersection (which resembles the on-ramp merging solutions) to achieve a safe crossing of vehicles [21,22,23,24]. Liu et al. proposed a cooperative trajectory planning strategy to pass through an intersection with V2X communication. The results showed that the proposed strategy has the smallest evacuation time among that in fixed lights and adaptive light [25].

Figure 1
figure 1

A typical complete AIM system

As a key component of the automated intersection management system, decision-making and planning of vehicles becomes one of the major tasks to be solved [26]. For example, rule-based decision-making approaches are commonly used in autonomous driving. However, such rule-based approaches are reliable and easy to interpret. For simple driving scenarios, it can achieve a good performance on safety with hand-engineered rules. But when dealing with complex urban environments, such as road intersections, where various uncertainties exist, a rule-based approach cannot maintain safe and efficient driving [27]. Thus, some other approaches with more intelligence, such as optimization and learning-based methods, have been widely discussed in past decades. Since no uniform model can handle all scenarios, the planning and decision-making methods of vehicles in the complex urban driving environment is still challenging. Refs. [28] and [29] uses optimization methods to generate paths and speed for the vehicles at intersections in the goal of reducing overall fuel consumption and increasing transportation efficiency, in fully connected and partially connected traffics. Where Ref. [30] also considered the quality of the generated path and introduced a heuristic algorithm to refine the trajectories of a team of connected vehicles. Refs. [31] and [32] implemented reinforcement learning to solve the problem considering safety, efficiency and task completion in connected and unconnected scenarios accordingly.

In this paper, we mainly focused on planning and decision-making technologies at road intersections, as shown in Figure 2. Firstly, we divide the general planning and decision-making technologies at intersections from the previous paper into several major approaches: graph-based approach, prediction-based, optimization-based approach, and machine learning based approach. Then, we summarized those technologies used in vehicle infrastructure cooperative environment. Both signalized and unsignalized intersection(s) are considered with purely automated driving traffic and mixed traffic. We believe the study learned from current strategies, protocols, and simulation tools help researchers identify the presented approaches’ challenges and determine the open issues for future research.

Figure 2
figure 2

Research scope of this survey

The rest of this paper is organized as follows: In Section 2, we introduce the general planning and decision-making technologies at intersections. In Section 3, we show that the Vehicle-Infrastructure cooperation control method for intersections. In this section, we also discuss in detail about the impact of wireless communication technologies. Then, we compare existed state-of-art under mixed traffic environment, and their according performances are studied in follow Section 4. Furthermore, the previous approaches’ challenges and determine the open issues for future research are discussed in Section 5. Finally, Section 6 concludes this paper.

2 General Planning and Decision-making Methods at Intersections

Planning and decision-making algorithms at intersections have been rapidly developed over the years. Which includes planning algorithms such as optimal trajectory generation within the topology occupation-free space, and decision-making methods which mainly focus on speed profile generation along the generated trajectory. These methods generally share the same major goal which is establish efficient, safe, and real-time behaviors of the ego vehicle. Overall, planning and decision-making algorithms of autonomous vehicles could be divided into several categories, which include graph-based approach, optimization-based approach and machine learning-based approach. These methods are explained as follows.

2.1 Graph Based Approach

Graph based method which is also widely used in mobile robotics could help vehicle find a path within the free space. At intersections, an explore searching method has been implemented, which is the rapid random tree search (RRT) method. The RRT method is first introduced by LaValle [33]. This algorithm could search a possible path under a very short period and could enable fast regeneration if the environment changes. The algorithm follows a growing tree based searching method, the tree growing method could be briefly concluded as, first, a point is randomly sampled in the free searching space, secondly, the newly sampled point and each of the tree nodes are connected, the distance is calculated from each of the tree nodes to the newly sampled point and a tree node is selected from certain heuristics, for example, the shortest distance. Then from the nearest point to the sampled point’s direction, a line with a predefined length is extended from the nearest point to obtain a new point (let us named it point x). Lastly, if the line segment between the nearest point and point x are within the free space, this point x and the connect line is attached as part of the search tree.

After the RRT method was proposed, many variants developed from this algorithm has been proposed. Some classic variations including the RRT* algorithm [34] and CL-RRT algorithm [35] which are two state-of-the-art variants in literature and are often been compared with as benchmarks. RRT* provides two additional steps compared with traditional RRT by adding a rewire process to the search tree growing process, and had shown that it could provide asymptotic optimal paths with enough searching time with proper modifications [36]. CL-RRT uses the closed-loop simulation while generating the tree to provide better feasibility of the generated paths. The algorithm first generate tree search paths, then instead of using straight lines to connect the nodes, it uses a simple controller to generate the path from the father node to the new node. This method enables better control feasibility as kinematic has been considered during the path generation process. With the emerging development of the RRT family, RRT-based algorithms had shown to satisfying performances and are widely applied in autonomous driving including intersection scenarios.

Ma et al. [37] implemented a variation of the RRT algorithms family to generate paths at an intersection. It makes uses of the road geometry in the first place and pre-generates splines accordingly as the base tree. Using the spline as the initial tree, more branches are generated so that a collision free path could be found. By regenerating the search tree repeatedly at a high frequency, obstacle avoidance could be performed. Chen et al. [38] formed the problem in to a hierarchical planning problem. The major method could be divided into three layers, high-level route planning layer, mid-level task planning layer and the low-level motion planning layer. The high-level route planning layer first generates several way-points given the road geometry. Then, the task planner generates tasks accordingly to the received way-points. Finally, the low-level motion planner generates real-time control commands for each tasks as intersections. Yoon et al. [39] introduced a spline-based RRT* algorithm which combined cubic Bézier polynomial curves and RRT* search method to achieve high efficient collision avoidance at intersections under continuous search space. Mehta et al. [40] introduced a human interface into the RRT algorithm which enables an additional experienced drivers knowledge that could assist the process of re-planning.

However, RRT algorithms are mostly implemented in maze and other static environments, with the complexity and fast-changing nature of intersections leads to conservative decisions and the refresh rate of the planner may be challenging in some critical corner case scenarios.

2.2 Prediction-Based Approach

Only considers and plans on the current state could be dangerous at times and might be insufficient to guarantee full-safety. Thus, planning considering the predicted future path of the environment vehicles is one of the very popular ways to solve intersection planning problems, crediting from the existing plentiful motion prediction and risk assessment algorithms [41,42,43,44,45,46,47,48]. Huang et al. [44] trained a variational neural network using multiple sensors to predict the conditional variational distribution of the possible future states of the ego vehicle.

The proposed algorithm is able to cooperate with various uncertainties and also are able to coordinate between different sensors’ information, by combining the physics-based model to the system, it can increase the prediction accuracy and other performances of the prediction process. Ref. [43] introduced an RNN-based method to predict the surrounding vehicle’s intentions using Lidar-tracking information. The recurrent neural network was trained by a dataset containing of unsignalized intersection naturalistic driving behaviors. The naturalistic driving dataset was also used to evaluate the performance of the prediction results. Using this method, the predictor was able to predict severe potential collisions for more than a second in advance. Jeong et al. [49] used support vector machine to predict the intentions of environment vehicles, given the predicted states, the vehicle could generate and perform human-like planning behaviors at unprotected intersections.

Jeong et al. [50] trained a long short-term memory-based RNN to predict the future states of the surrounding vehicles, with the prediction results, the planner was able to increase safety. Wang et al. [51] operates the precision process using the probabilistic occupancy to predict the motions of vehicles with Monte Carlo simulation, the prediction model was preset and which is obtained from off-line training, then it is used for on-line planning to achieve good real-time performance of planning result. Ref. [52] also introduced a LSTM model that combines intention estimation and trajectory prediction, the framework first trained a high-level intention estimator to predict the rough path of the vehicle at intersections then it performs a more detailed trajectory prediction at intersections. For the prediction and planning framework, if the prediction result is sound and accurate, this type of methods could provide sufficient safety performance and could be implemented under different scenarios. Therefore, developing and applying these path prediction and risk assessment algorithms, the result of the intersection planning performance could be improved greatly.

2.3 Optimization Based Approach

Another popular approach for planning at intersections is by modeling the planning problem into a real-time optimization problem, by properly study and set up the cost function and boundaries as well as constrains, planning and decision-making could be operated in a heuristic manner. One major type of optimization method used for autonomous driving at in intersections is the model predictive control method. The key components in a model predictive control framework include an obstacle model, a vehicle model and a proper optimization solving method.

The vehicle model includes the point-mass [53] model which takes the vehicle as a single point with a certain mass, which does not consider the vehicle’s shape or kinematic [54] or dynamic [55]. The kinematics model on the other hand, takes in the vehicle geometry into consideration which is often used in path planning, one classical type of formulation of the kinematic formulation are knows as the bicycle modeling. The dynamic model is established considering the dynamic characters of the vehicle, which could include tire model, vehicle body dynamic model which are nonlinear, and are often used in vehicle control problems and highway scenarios with large or rapid change lateral forces. The obstacle model which are established and set for obstacle avoidance includes 2 types of classical approaches. One of them is through setting a virtual repulsive force as part of the reward function to add forces to keep a safe distance from the obstacle to the ego vehicle, this type of formulation are also known as the potential field method. A variable for additional slackness could be added to the constraints of the optimization process, which are able for more acceptable feasibility. However, sometime this kind of modifications could lead to nonconvex and nonlinear cost functions, and proper linearization or approximation for the optimization process is necessary. One of the other approach is through properly setting the constrains which allow the ego vehicle to operate within the obstacle-free space, but in reality, the constrains obtained from the real-world are most likely nonconvex. Solving those nonconvex problems could lead to very high computation power requirements, therefore, the model is often modified to a linear programming (LP) problem, quadratic programming (QP) problems [56], etc. or dynamic programming problem. After the model has been properly established and set to a typical optimization problem, then this problem is solved by using the corresponding optimization solver.

Optimal control method such as model predictive control (MPC) has been broadly developed and used in solving planning and decision-making problems for autonomous vehicles at intersections. Authors in Ref. [57] designed a Robust Model Predictive Control planning algorithm to guarantee sufficient safe gaps at critical intersection scenarios. This method improves the driving efficiency and driving comfort and also refines the model with “Affine Disturbance Feedback”. Ref. [51] introduced a hierarchical method for planning at intersections, it first used road geometry to generate some reference initial trajectories, then model predictive control was used to optimize the initial trajectories and generated decisions and the corresponding motions along the refined path. During this process, the constrains and optimization boundaries of the optimization problem was easy to be implemented through coordinate transformation. For the final level, probabilistic-occupancy grid-based predictions of environment vehicles which were obtained before-hand to enable better real-time performances. The simulation results have showed that there exists good improvement of the planned path and speed, which also demonstrated the efficiency of the proposed approach.

Hult et al. [58] presented a bi-level (coordination arrangement level and vehicle motion planning level) MPC for intersection planning. Which coordinated occupancy time slots before the vehicle enters the intersection and provides ego vehicle direct control inputs separately. This approach had shown solid improvements on the feasibility and stability of the planning performance at the intersections with certain assumptions. Nilsson et al. [59] used two loosely coupled MPCs to enable better planning performance, the idea of decoupling of the longitudinal and lateral of the vehicle control is introduced and the two MPCs are assigned to each direction accordingly. Liu et al. [60] introduced a MPC model that could automatically select appropriate parameters for various types of maneuvers to increase the generality usage of the planner. To obtain better driving comfort, a special lane-associated potential field was implemented. Also, the environment vehicles are seen as polygons which are modified to be converted into hard constraints in the MPC problem to ensure safety. Ref. [61] generates speeds of the vehicle within a fixed generated path from a set of waypoints by using temporal optimization. However, the problem turns out to be nonconvex. To solve this problem, the MPC problem was simplified by a set of quadratic programs and were solved by the slack convex feasible set (SCFS) algorithm to improve the real-time performance of the proposed method. Ref. [17] formed the two-dimensional intersection steering and acceleration planning problem into an optimization problem, the motion dynamics of ego vehicle were considered in a distance scale instead of a time scale. The optimization problem was solved based on Minimum Principle of Portraying.

Other optimal control methods such as the Bezier curve optimization method is implemented for intersection planning. Ref. [62] considers constrains such as collision avoidance and formulates the planning problem as an optimization problem under equality constrains. Then, the optimization is solved using Quadratic programming (QP) and Hildreth’s algorithm. Ref. [63] assumed that the ego vehicle is able to detect all surrounding obstacles. With this assumption, it introduced a reactive and adaptive path planner and also formalized the problem as a Bezier curve optimization problem with certain constrains and solved it using Lagrangian and gradient-based methods.

2.4 Machine Learning Based Approach

Machine learning (ML) approach has been a boosting approach due to the prosperous development of the artificial intelligence and the wider application of the computer science. By using these ML approaches, the ego vehicles is able to implement more human-like driving behaviors by studying from naturalistic driving data or from driving expert experiences. Using those methods, the ego vehicle is able to cooperate under complex scenarios.

2.4.1 End-to-End Neural Network Approach

One common approach for the neural network (NN) approach is the end-to-end approach, that is, by feeding in the images and sensor information of expert drivers driving at intersections and the actual actions of the drivers at such scenarios, a NN network is trained so that when at a similar scenario, giving the original input from the sensors, the model will be able to directly provide actions as output. This mean that the logic in the decision-making from perception to action is embedded in the NNs. Ref. [64] uses end-to-end methods as the core of its proposed algorithm, however, they used 360-degree camera instead of only using front camera as classical end-to-end planners would do. The trained network has also been carefully modified to adapt to the new censoring format. Also, a route planner is added to help the driving task significantly. Which as result, this proposed method could decrease the chances of collision at intersections. Instead of only having camera input for classical end-to-end methods, Ref. [65] took LIDAR and HD maps as inputs which enables a 3D interpretation, the paper put the newly proposed method into real-world practice, and the learned cost volume could help the ego vehicle perform more safely at intersections, and the vehicle is able to handle traffic light while interacting with the surrounding traffic participants.

2.4.2 Reinforcement Learning Based Approach

Reinforcement learning (RL) is also a common approach for intersection decision-making and planning for autonomous vehicles, for classical RL problems the reward functions are set up using the expert driving knowledge, and shall be fine-tuned for better performance. However, with the development of the NN networks, these approaches are commonly combined with neural networks to better learn from human expert behaviors which enables better feasibility. Bouton et al. [66] introduced a safe RL algorithm using a method called model-checker to improve safety, they also used a learning based belief update method which allows the applied method to better coop with occlusions and sensor-obtained errors. Ref. [67] enabled general decision-making of intersection vehicles at occluded multi-lane intersections. The reward function combines risk assessment and the NN-based Q network is used to estimate the possible risk, which enabled the planner to enable less cation actions but at the same time ensures safety. Ref. [68] studied typical behaviors of other vehicles which enable the ego vehicle to better coop with environmental interactive vehicles at intersections. The speed profile of the surrounding vehicles and the dynamic distance from the environment vehicles to the ego vehicle was evaluated and are later on considered in the model to perform different types of driving behaviors. This algorithm proposed enables the ego vehicle to cross the intersection safety since it avoid collision almost in most of the operation period, this performance has outperformed many state-of-the-art models at that time. Ref. [69] introduced an intersection planner and decision maker that considered the operational-level control of the vehicle at intersections. The planner takes the hard dynamic and kinematic constrains of the ego vehicle into consideration in the deep RL model, this increases the feasibility of the general-level planning outcomes in the real-world intersection planning scenarios, and the feasibility of using the algorithm in applications was verified by simulations. Isele et al. [70] combined reinforcement learning and NN to learn active sensing behaviors to achieve safety in a congestion intersection environment. Qiao et al. [71] learned the policies of intersection scenarios with automatically generated curriculum (AGC) to increase the learning process. The performance of the deep reinforcement learning approach is closely related to the training data, and it is a crucial thing to obtain accurate, complete, and sound dataset to let the model learn all the possible scenarios which leads to safer and better planning and decision-making outcome.

2.4.3 Partially Observable Markov Decision-Making Process Approach

In a Markov decision-making process (MDP) model, all the states, transfer functions, reward functions, etc. are considered to be static. However, in the real-world application and modeling, the states of the participants and environment are not always fully observable. Thus, to represent this uncertainty of the real world, a partially observable Markov decision-making process (POMDP) based approach has been widely applied and is becoming an emerging technique for highly interactive intersection planning problems for self-driving vehicles. POMDP is a decision-making framework for the agent in an uncertain scenario. The model is able to merge the uncertainties formulation into its own framework, for decision-making and planning of self-driving vehicles, these uncertainties could be sensors perception noise, surrounding drivers’ intention uncertainties, future paths uncertainties and control output uncertainties. The agent would receive an observation from the reward after a decision had been generated at each time step [72]. The major approach for solving the POMDP problems could be categorized into two types, one of them is the exact solution methods and another one is the approximate solution methods. For real-world intersections planning problems which is very complicated, an exact solution is often impossible to find in real time, therefore, it is common to obtains approximate results as the solution.

Bouton et al. [73] navigated the ego vehicle at intersection scenarios where frequent changes usually occurred by modeling the problem into a POMDP problem and solved the problem using Monte Carlo tree search (MCTS) method, the presented results proved that the planner outperform the threshold-based heuristic method in both safety and efficiency. Ref. [74] also formulated the intersection planning and decision-making problem into a POMDP problem, the paper modeled the unknown intention of the surrounding vehicles with a probabilistic model and merged that into the observation model of the POMDP model. By solving the POMDP problem, the ego vehicle was able to make decisions in a continuous space on a fixed path at intersections in an online manner. Extend from Ref. [74], Ref. [75] proposed an intersection planning and decision model that the model is able to coop with multiple surrounding vehicles and was capable to outperform the base-line method in computation time, the proposed POMDP model was also able to operate in a continuous state space. Due to the curse of computational complexity, planning methods using POMDP methods often plans the vehicle’s speed on a fixed path. However, this indicates that the intersection is not fully explored, Refs. [76, 77] proposed a critical turning point (CTP) concept that enables the ego vehicle to generate several candidate paths to select and follow. which the candidate paths are generated through quintic polynomials. Given the candidate paths, the ego vehicle is able to select a candidate path and then plan speed along the selected path based on the beliefs of the uncertain intentions of the oncoming vehicle. Therefore, the intersection space is better explored under a limited amount of computational power.

Ref. [78] considered occlusion caused by both dynamic and static objects, and represented the movements of the surrounding vehicles in the observation filed (OF) and the phantom vehicles as reachable sets. This enabled the ego vehicle to operate in urban intersections and perform less conservative yet safe actions compared to the traditional method. Brechtel et al. [79] considered several kinds of uncertainties and predicted the results from different actions due to various assumptions in the proposed algorithm. The authors did not applied symbolic representation to represent the state-space for all the possible cases, instead, they used a continuous solver that represents specific situations. Ref. [27] developed decision-making at generalized congested intersections that avoided both static and dynamic obstacles. The objects in the observable area were being predicted and the objects in the occluded area were modified with more attention to avoid dangerous collisions. The proposed algorithm was able to generate human-like behaviors at uncontrolled intersections.

3 Vehicle-Infrastructure Cooperation Method for Intersections

3.1 Cooperation Methods in Signalized Intersection

Research on optimization algorithms on traffic conflict at intersections began at the end of the last century. Since the concept of CAV has not yet emerged at that time, the early research on traffic optimization algorithms focused on the study of signal timing, i.e., optimization on the traffic signal phase and timing (SPAT).

In 1998, Schutter used optimal control to minimize the queuing length [80]. At the beginning of this century, the second wave of artificial intelligence also affected the field of transportation management. Bingham used a fuzzy neural network method to optimize SPAT [81]. Wiering [82] and Abdulhai [83] introduced reinforcement learning into the field of SPAT optimization. They innovatively regarded the traffic lights in continuous intersections as multiple agents. Through the communication equipment, i.e., V2X technology as shown in Figure 3, the central coordinator collects the position and velocity of the CAVs. Estimation on the waiting time of the vehicles at the intersection is further accomplished to be used in SPAT optimization. In the optimization process, minimizing the waiting time of all CAVs is taken as the optimization target. Q-learning method is applied to optimize the SPAT of multiple intersection traffic lights. Duan extended the previous method, adopting different optimization goals in different traffic flows, and collaboratively optimizing the timing of multiple signal lights [84].

Figure 3
figure 3

Illustration of the traffic light optimization in signalized intersections [84] (CAVs upload their information to the traffic control center through the wireless network. The optimized SPAT is sent to the controller at each intersection)

With the merging development of automated vehicle technology, researchers have gradually taken CAVs into consideration for traffic optimization at intersections rather than merely collecting the CAVs’ information.

The most commonly-known research in this field is the predictive cruise control algorithm proposed by Asadi [85]. First, through V2I technology, the CAV obtains the SPAT information of several consecutive traffic lights ahead. The time window of the continuous traffic green lights provides hard constraints to CAV control. Then, combined with the vehicle model, model predictive control (MPC) is applied to control the CAV to drive through several consecutive traffic lights with no idling at the intersections. Through continuous velocity trajectory planning, the overall travel time of the CAVs is significantly reduced. In this algorithm, CAVs are guaranteed to pass multiple intersections without stopping, which is also named as green wave traveling in later research. Xu proposed a hierarchical cooperation optimization method for the traffic light and CAVs [86]. In this study, considering the complex coupling relationship between signal light time allocation and CAV driving strategy optimization, Xu decoupled the problem into the upper-level traffic efficiency optimization problem and the lower-level CAV control problem as shown in Figure 4. In the proposed hierarchical control method, the upper-level controller optimizes the overall traffic flow and provides each CAV a target arrival time at the intersection. The lower-level controller optimizes the fuel consumption of CAV based according to the received arrival time, i.e., a terminal time constraint in the optimization.

Figure 4
figure 4

Illustration of the hierarchical cooperation optimization method for the traffic light and CAVs in Ref. [86] (The traffic efficiency is optimized at the upper controller and the fuel consumption at the lower controller. Vehicle arrival time is the intermedia value)

3.2 Cooperation Methods in Unsignalized Intersection

Since CAVs obtain traffic light SPAT in advance, it is unnecessary to keep the traffic light if all vehicles are CAV. In approaching the intersection, each CAV is capable of scheduling the arrival time and optimize its speed trajectory. However, the routes of incoming CAVs have complicated conflict relationships at intersections. Therefore, obtaining a high-efficiency conflict-free arrival plan is a priority in CAV scheduling. Researchers have also pointed out that the passing order of the vehicles is the key factor influencing traffic mobility at intersections [87, 88].

As incoming CAVs approach the intersection from different directions, the optimal passing order changes constantly and the solution space increases exponentially, preventing the determination of the optimal passing order using the brute-force method. This problem is typically solved using a reservation-based method [89]. The most straightforward reservation-based solution is the first-in-first-out (FIFO) strategy, in which vehicles that enter the intersection first are scheduled to leave it first [14, 86, 90]. There exist plenty variants of the basic FIFO strategy. In Ref. [91], the FIFO strategy is extended into platoon based scenarios, i.e., the scheduling unit is a CAV platoon rather than single CAV. In Ref. [92], the scheduling is made according to CAVs’ estimating arrival time at the intersection. In Ref. [93], the queuing theory is introduced to dissipate the accumulating CAVs.

However, the FIFO passing order is not likely to be the optimal solution in most cases. Batch-based strategy is an improved version of the FIFO strategy, and it processes the vehicles in batches according to their direction to reduce the traffic delay [18]; however, its performance has not been fully optimized. Another widely used strategy is the optimization-based method. After formulating the scheduling problem as an optimization problem, various methods have been proposed to find the optimal passing order. Ref. [74] POMDP to formulate the problem, and used the adaptive belief tree algorithm to find the optimal passing order. Ref. [94] proposed a similar method to create a tree representing all possible solutions of the pass order, where the leaves of the tree stand for the complete scheduling plan. Guler [95] proposed an iterative algorithm to find the optimal passing order. In Ref. [96], they extended their work and proposed two central problems of intersection management: (1) Find the optimal arrival/departure sequence of CAVs, (2) Once they know the arrival/departure time, CAVs can obtain their optimized speed trajectory through various control methods, e.g., optimal control. In their research, they used the branch and bound method to find the best arrival/departure sequence. Guney [97] used particle swarm optimization (PSO), and Lu [98] used mix integer linear planning (MILP) to solve similar problems. Liu [99] transformed the centralized optimization problem into a distributed optimization problem, and solved the problem locally on each vehicle to find the best solution. In Ref. [100], a queue-based method was introduced to find the optimal solution that leads to the smallest average delay. Similar ideas are also applied in Ref. [101].

Apart from these specific methods, some researchers have also noticed that finding the optimal passing order of multiple CAVs is a discrete problem rather than a continuous problem, and thus graph theory is considered a promising methodology to describe and solve this problem. Studies have modeled the problem using graph theory by employing the conflict graph analysis to optimize the traffic-signal phase plan [102, 103]. However, the scheduling of multiple CAVs is more difficult than scheduling a limited number of traffic signal phases because the number of incoming CAVs is much larger than the number of traffic signal phases. Some methods have been proposed to address this difficulty. Apart from the depth first spanning tree (DFST) algorithm proposed in Ref. [6], Petri net [104] and conflict duration graph [105] are also used in modeling the scheduling problem. However, the discussion on the optimality of the scheduling problem of multiple CAVs is inadequate.

To tackle the problem of optimality, mathematical modeling, i.e., the computational reduction of the intersection scheduling problem, is an essential research aspect. Some researchers have focused on reducing this problem into typical algorithmic problems, including the job-shop scheduling problem [106], abstraction-based verification problem [107], and polling system problem [108]. In Refs. [109, 110], the problem is reduced to minimum clique cover problem, i.e., a classical NP-hard graph theory problem and a heuristic method is proposed to find the optimal passing order with high efficiency.

3.3 CAV Control Methods in the Cooperation

CAV control involves two aspects: longitudinal control and lateral control. In most of the previous research, lateral control is neglected by assuming the CAVs are running on their target lanes. Longitudinal control is the fundamental control problem in intersection management.

Considering a fully autonomous intersection scenario, a hierarchical framework is frequently used to realize the CAV coordination [86]. First, after collecting the information of the CAVs in real-time, the centralized controller schedules the arrival time of the CAVs to improve the traffic efficiency. Then, a distributed controller is applied to the CAV to implement the determined arrival plan. Multiple methods have been proposed to address the vehicle control problem. Milanés proposed a fuzzy logic method to optimize the speed trajectories of two CAVs [111]. Onieva used the fuzzy logic method to analyze the relative driving conditions of a CAV and a conventional vehicle. Then genetic algorithm is used to optimize the control parameter of the vehicle [112].

Malikopoulos claimed that at multiple intersections, a distributed optimal control method is suitable to minimize fuel consumption and maximize intersection flow [113]. In this paper, the definition of the CAV information set is given, and it is proved that whether the flow maximization problem has a feasible solution is only related to the hard constraints of the CAVs. They further proposed the application of the distributed optimal control method in multiple intersections [114], and provided the proof of the feasible solution conditions of the method [115]. Moreover, the virtual platoon method was proposed in Ref. [6], which projects the CAVs from different lanes into a virtual lane. Thus, the typical vehicle platoon analysis methods [116] can be used in the control problem of the CAVs on different lanes as if they are traveling in the same lane.

Energy consumption is the main focus of intersection cooperation. Eco-approaching focuses on the CAV approaching process, which is the main focus on most of the research. Avoiding queuing [117, 118] and green wave driving [119, 120] are two common research topics. Human driving error [121] and mixed traffic [122] are also discussed in some research to further improve the fuel economy. Eco-departure is another types of research which focus on the CAV leaving process. Ref. [123] optimizes the departure process of a CAV platoon to minimize the energy consumption.

In the aforementioned studies on intersections, the CAVs were assumed to run in their target lanes, i.e., only their longitudinal control was considered. In practice, however, CAVs approach from random lanes and have different target lanes; therefore, it is necessary to extend this research to scenarios that permit lane changing. Earlier studies on this topic focused on obtaining a smooth CAV speed trajectory [124, 125]; however, traffic efficiency was not investigated completely. With regard to CAV scheduling, which we are concerned with, a few studies formulated this problem as an MIP [126] or a linear programming problem [127]. This was done by assuming that lane changing maneuvers are accomplished in a given time interval. Ref. [128] proposed a practical bi-level framework, where the high-efficiency arrival plans and collision-free path planning are solved on the upper and lower levels separately. Ref. [129] proposed a practical method to decouple the longitudinal control and lateral control of the CAVs. Several other prospective studies also focused on changing lane directions dynamically rather than allocating CAVs to constant directional lanes [130,131,132]. However, flexible lane directions are unsuitable for a mixed traffic environment, where human-driven vehicles (HDVs) and CAVs coexist.

4 Planning and Decision-making Method under Mixed Traffic

For real-world implementation of CAVs, essential requirements include equipment of connected devices, e.g., being equipped with vehicle-to-vehicle or vehicle-to-infrastructure equipment [133], and capabilities of autonomous control, i.e., being directly operated by industrial personal computers or microcontrollers [134]. According to the Department of Transportation of US, it will take 20‒25 years to realize 95% MPR of connected vehicles [135], and based on the estimation of Ministry of Industry and Information Technology of China, the MPR of partial/conditional autonomous vehicles is expected to reach 25% by 2025 [136]. Considering the long-term deployment of CAV technologies, research on mixed traffic environment of CAVs and HDVs is of great importance to improve traffic mobility at intersections in the near future.

4.1 Traffic State Estimation under Mixed Traffic

The aforementioned research mainly considered a fully-autonomous scenario—the market penetration rate (MPR) of CAVs is 100%. In practice, however, it might take decades for all the HDVs in current transportation systems to be transformed into CAVs. Instead, a more practical scenario in the near future is a mixed traffic system where CAVs and HDVs coexist [137].

Existing research on mixed traffic intersections mostly focused on the estimation of traffic states and optimization of traffic signals. For example, Priemer et al. utilized dynamic programming to estimate the queuing length in the mixed traffic environment and then optimized the traffic phase time based on the estimated results [138]. Feng proposed hierarchical architecture to allocate the traffic SPAT [139]. Estimation of location and speed (EVLS) method was built to segment the incoming road. Afterwards, the HDVs’ driving information is estimated based on the segmentation. Using fuzzy logic, the traffic condition on the environment was also estimated in Ref. [140]. Ref. [9] proposed a method to combine the vehicle arrival time and expectation maximization to estimate the traffic flow. The fundamental idea of the research is to estimate the HDVs’ trajectory and traffic flow through CAVs’ trajectory.

To improve the estimation accuracy, the celebrated results on microscopic car-following models have been recently employed to describe the behaviors of HDVs, including Gipps Model [141], Optimal Velocity Model (OVM) [142] and Intelligent Driver Model (IDM) [143]; see, e.g., Refs. [144, 145].

4.2 CAV Control under Mixed Traffic

Despite these existing works, the topic of CAV control, i.e., trajectory optimization of CAVs, in mixed traffic intersections has not been fully discussed. To tackle this problem, several works regarded HDVs as disturbances in the control of CAVs [118, 144], or focused on the task of collision avoidance based on the prediction of HDVs’ behaviors [30, 122]. It is worth noting that most of these methods were limited to improving the performance of CAVs themselves in their optimization frameworks, instead of optimizing the global traffic flow consisting of both HDVs and CAVs at the intersection. Two notable exceptions are in Refs. [29, 146], which attempted to improve the performance at the signalized intersection from the perspective of the so-called mixed platoon. They enumerated several possible formations consisting of HDVs and CAVs, and investigated their effectiveness through small-scale simulation experiments. Ref. [147] clarify a general and explicit definition of the “1 + n” mixed platoon as shown in Figure 5. A concise conclusion is made that the stability and controllability of the proposed platoon structure is irrelevant to the platoon size.

Figure 5
figure 5

Schematic for the “1 + n” mixed platoon (Red arrows denote the information flow of the leading CAV (colored in red), which collects information from the following HDVs as well as the traffic light and has an external control input. Black arrows represent the information flow of the HDVs (colored in black), which are under control by human drivers and only acquire information from the preceding vehicle)

In fact, considering the interaction between adjacent vehicles in the same lane, it is easy to understand that velocity trajectories of CAVs could have a certain influence on those of surrounding vehicles, especially the vehicles following behind them. Accordingly, the driving strategies of CAVs could have a direct impact on the performance of the entire mixed traffic intersection; such impact might even be negative when inappropriate CAV strategies are adopted [118]. By contrast, when taking the performance of entire mixed traffic into explicit consideration, the optimization of CAVs’ trajectories could bring further benefits to traffic mobility. Such idea of improving the global traffic performance via controlling CAVs has been recently proposed as Lagrangian Control of traffic flow [148], which has been discussed in various traffic scenarios, including closed ring road [137], open straight road [149], traffic bottleneck [150], and non-signalized intersection [151].

The vehicle trajectory planning problem in mixed traffic environment is similar to that of the 100% MPR conditions, which is interpreted in Section III-C. The difference of vehicle trajectory planning in mixed traffic environment is that the HDV behavior has influence the CAV trajectory planning result. Typical methods to solve the problem include shooting heuristic method [30], preceding horizon method [152] and event-triggered algorithm [147].

5 Discussion and Potential Research Direction

Based on the planning and decision-making technologies mentioned above, we summarize the current open issues and discuss several critical future research directions on planning and decision-making at intersections in this section.

5.1 Penetration Rate of CAVs and Level of Automation

The penetration rate of CAVs shows significant influence to the performance of the above planning and decision-making methods [72, 122, 153]. Higher penetration rate of CAVs usually means better performance in many methods. In fact, many existed studies assumed 100% penetration rate of CAVs with fully automation to reduce the complexity of the planning and decision-making model. Full information of all vehicles can be used and/or all vehicles can be controlled to better design the intersection planning and decision-making methods, this guarantees conflict-free vehicle cooperation [86, 110]. However, we all know that the 100% penetration rate of CAVs and fully automated vehicles (i.e., level 5) need much more time than we expected, despite the grows of the number of CAVs and the development of CAVs’ technologies. Therefore, it is important to analysis the performance of the proposed planning and decision-making models at intersections under mixed traffic scenarios. It will make the method more piratical and convincing if it could handle traffic with both human-driven vehicles and CAVs, with and without connectives, and with different levels of automation [154, 155].

Moreover, some studies demonstrated that there existed a significant changing point of the performance along with the increasing of the penetration rate of CAVs. Niroumand et al. developed a program to program to control the trajectory of mixed connected-automated vehicles (CAVs) and connected human-driven vehicles (CHVs) through signalized intersection. The results indicate that the proposed program will become the dominant signal indication after the CAV market penetration rate of 80% [156].

Although there is several remarkable research related to the impact of the penetration rate of CAVs, there are still many problems need to be explored. As a good starting point, it is urgent to conduct more complex intersection planning and decision-making scenarios with different penetration rate of CAVs. Meanwhile, previous studies usually adopted simulation-based model to study the impact of the penetration rate. Developing theoretical models or theoretical simulation combined models can better verify the impact of penetration on intersection planning and decision-making performances.

5.2 Reliability of Communication

The rapid development of the V2X technology provides an opportunity to improve traffic mobility and safety in intersection management [133]. Through vehicle-to-vehicle (V2V) and vehicle-to-infrastructure (V2I) communication, a centralized controller is deployed at the intersection to coordinate the connected and automated vehicles (CAVs) to pass through the intersection. Same as the penetration rate of CAVs, many current studies assumed perfect communication environment to support the planning and decision-making method [157, 158]. However, communication issues, such as latency [159], package loss [160], band-width [161, 162], is highly affect the model performance at intersections. It is hard for a traffic engineer to understand what makes these issues occur. However, more efforts to develop a method with robustness to these issues need to be conducted. Liu et al. considered vehicle coordination at signal-free intersections with latency [163].

Although these factors to impact the reliability of communication has been studied by the networking community and the control community, we still lack a connection between communication performance and intersection level planning and decision-making performance.

5.3 Driver Behavior of CAVs at Intersections

Significant amount of research has been done on the driver behavior under homogeneous traffic conditions at intersections [164], however little or no research has been found on mixed traffic conditions, where vehicles do vary in physical and dynamic characteristics [165]. As for mixed traffic with CAVs and human-driven vehicles, fewer studies related to the area.

Since there are few CAVs in real-world, researchers mainly using simulation approach to analysis the driver behavior of CAVs under mixed traffic at intersections [166,167,168]. R Arvin et al., evaluated the safety performance of CAVs at intersections. A simulation framework was developed, and Adaptive Cruise Control (ACC) and cooperative CACC car following models are used to mimic the behavior of CAVs [169].

The nature of human planning and decision-making at intersections has significant research value. A well-developed driver behavior is robust to environmental uncertainties and can well capture the real-world behavior of human drivers. By adapting the driver behavior model, vehicles with more accurate predictions of human actions can be provided when operating in mixed traffic environments.

5.4 Multi Intersections Coordination and Optimization

The current planning and decision-making technologies using CAV mainly emphasized on isolated intersection. Few of them discussed coordination and optimization between two or more intersections. The main challenge of Multi intersections planning and decision-making is how to use CAVs and other communication devices to coordinate multiple intersections, and how to effectively solve the resulting large-scale problems. These issues require further specialized investigation. Bui et al. focused on optimizing traffic flow at multiple intersections using Cooperative game-theoretic approach [170]. Zhang et al. coordinated control of traffic signals between intersections using adaptive genetic algorithm based on cloud computing [171].

Analyzing the planning and decision level coordination and optimization for multi intersections still needs more efforts to conducted. Finding global optimal solution with avoid falling into a local optimum and has fast solution efficiency can significant improve the mobility of the transportation system.

5.5 Multi-objective Multi-agent Planning and Decision-making

The traffic condition at intersections very complicated. The geometry of the intersection is often inconsistent and participants are various. Therefore, the planning and decision-making objectives for each traffic participants at intersections are usually different. Current algorithms for optimizing traffic operations at an isolated intersection consider mostly one objective function [19, 66, 170]. For example, vehicle delay is main factor to impact traffic mobility. The approach to optimize vehicle delay can lead to long pedestrian waiting times as well as reducing safety conditions at the intersection. We know that some optimization goals cannot be achieved at the same time, and some are even contradictory. How to balance or adjust the final collaborative optimization according to different purposes is one of the research directions. Ref. [172] presented a multi-criteria optimization approach to the isolated intersection. The trade-off algorithm between vehicle and pedestrian delay is developed. The proposed approach is tested and showed that by worsening vehicle delays, pedestrian delays can be improved. Ref. [173] developed a multi-objectives model that considered including guaranteeing CAV safety, alleviating traffic congestion, and improving the performance of fuel consumption.

With the development of future research, at least two different intelligent bodies such as roads and vehicles will appear in the entire autonomous transportation system. How to coordinate and solve the planning decision-making problems between different agents will affect road safety and the efficiency of the entire transportation system. At present, there are two solutions for intelligent decision-making technology in autonomous driving technology: one is a rule-based [174], and the other is a solution that is constantly iterated through artificial intelligence [175]. Among them, the rule-based solution requires manual construction of a very complex rule structure, which can happen; while artificial intelligence uses neural networks, confrontation networks and other” black box” processing solutions, the driving behavior of autonomous vehicle drivers is closer to human driving behavior.

5.6 Real World Testing and Implementations

Real world testing and implementations for planning and decision-making under CAVs at intersections is another critical research direction in the area. There are thousands of papers related to planning and decision-making methods since 2000’s and the majority of them are simulation-based [26, 176, 177]. In the early stages of research in this field, it is acceptable to avoid using real data. Because in the beginning, it was just to prove that some algorithms are feasible for planning and decision-making at intersections. However, along with the development of different planning and decision-making methods, the data itself plays more and more important roles in problem formulating, model building, and algorithm developing. In simulation environment, we could simplify many issues caused by traffic data, such as observation errors, data lost, and data noise. Meanwhile, for traffic state estimation using real-world observed data, observation errors are inevitable when applied to real traffic systems [178]. Sometimes it may cause bias and even failures of the theoretical methods develop by simulation environment. To conduct initial testing/validation of the methods, there are several large-scale CV/probe vehicle data sets at intersections that researchers can use, which including the Interaction dataset [179], highD dataset [180], and the inD dataset [181].

How and to what extent could the errors using real-world data influence the accuracy and robustness of the models are important research topics.

5.7 Energy Conservation

In the past decades, the transportation system has resulted in increased air pollution and energy waste issues. Passenger vehicles are a major pollution contributor, producing significant nitrogen oxides, carbon monoxide, and other pollution. The Environmental Protection Agency estimates that vehicles cause nearly 75 percent of the carbon monoxide pollution in the United States. China claims that the country would reach peak carbon-dioxide emissions by 2030 and achieve carbon neutrality before 2060. When vehicles pass through intersections, the complexity and uncertainty of the environment often lead to incomplete planning and decision-making, which causes congestion. Traffic congestion usually leads to high energy usage and air pollutant emissions. Therefore, the urgent need to reduce the transportation sector fuel consumption levels requires researchers and policymakers to develop various advanced energy conservation strategies for planning and decision-making at road intersections. There are two major types of research topics in this area. One focuses on the CAVs approaching process, and the other focuses on the CAVs leaving process. For CAVs approaching process, avoiding queuing and green wave driving are two common research topics. Ref. [117] developed an Eco-CACC algorithm that computes the fuel-optimum vehicle trajectory through a signalized intersection by ensuring that the vehicle arrives at the intersection stop bar just as the last queued vehicle is discharged. The result demonstrated that the proposed Eco-CACC system produces vehicle fuel savings up to 40%. Meanwhile, human driving error and mixed traffic are also discussed in some research to improve energy conservation further. As for CAVs leaving process, eco-departure technologies draw researchers’ attention to the CAV leaving process. Ref. [123] analyzed the eco-departure of CAVs With V2X communication at signalized intersections. The results showed that eco-driving has the potential to save fuel for CAVs. However, its realization requires accurate control of the engine and transmission. Although there are several publications related to energy conservation at a road intersection, there is still lots of research and work that needs to be done in this area. The assumption of the existing papers is usually too idealistic. Maybe the research work’s good starting point is to analyze the planning and decision-making under an unsignalized intersection environment.

6 Conclusions

This paper summarized the studies related to planning and decision-making technologies for CAVs at road intersections. The focus of the research is how to make AVs and CAVs pass the intersection safely and efficiently. We searched several digital libraries for papers published from the last five years and summarized the main themes. The review started with general planning and decision-making technologies, four major approaches are presented: graph-based approach, prediction-based approach, optimization-based approach and machine learning based approach. Then, the review summarized Vehicle-Infrastructure cooperation control method. With the wire-less communication technology development, some planning and decision-making methods deployed by the centralized controller at intersections to coordinate the CAVs to pass through the intersection through vehicle-to-vehicle (V2V) and vehicle-to-infrastructure (V2I) communication. Finally, the review summarized planning and Decision-making method under mixed traffic. After carefully review the previous studies, the review identified the presented approaches’ challenges and pointed out the open issues for futures research. Detailed discussions were also provided to present several future research needs and directions in this important area.

References

  1. The future economic and environmental costs of gridlock in 2030, Report for INRIX, 2014.

  2. C B Rafter, B Anvari, S Box. Traffic responsive intersection control algorithm using GPS data. 2017 IEEE 20th International Conference on Intelligent Transportation Systems (ITSC), IEEE, 2017: 1–6.

  3. E Onieva, U Herna´ndez-Jayo, E Osaba, et al. A multi-objective evolutionary algorithm for the tuning of fuzzy rule bases for uncoordinated intersections in autonomous driving. Information Sciences, 2015, 321: 14–30.

  4. Y Rahmati, A Talebpour. Towards a collaborative connected, automated driving environment: A game theory based decision framework for unprotected left turn maneuvers. 2017 IEEE Intelligent Vehicles Symposium (IV), IEEE, 2017: 1316–1321.

    Google Scholar 

  5. B Qian, H Zhou, F Lyu, et al. Toward collision-free and efficient coordination for automated vehicles at unsignalized intersection. IEEE Internet of Things Journal, 2019, 6(6): 10408–10420.

    Google Scholar 

  6. B Xu, S E Li, Y Bian, et al. Distributed conflict-free cooperation for multiple connected vehicles at unsignalized intersections. Transportation Research Part C: Emerging Technologies, 2018, 93: 322–334.

    Google Scholar 

  7. S A Fayazi, A Vahidi. Mixed-integer linear programming for optimal scheduling of autonomous vehicle intersection crossing. IEEE Transactions on Intelligent Vehicles, 2018, l3(3): 287–299.

  8. M K Shi, H Jiang, S H Li. An intelligent traffic- flow-based real-time vehicles scheduling algorithm at intersection. 2016 14th International Conference on Control, Automation, Robotics and Vision (ICARCV), IEEE, 2016: 1–5.

    Google Scholar 

  9. J Zheng, H X Liu. Estimating traffic volumes for signalized intersections using connected vehicle data. Transportation Research Part C: Emerging Technologies, 2017, 79: 347–362.

    Google Scholar 

  10. S Sunkari. The benefits of retiming traffic signals. Institute of Transportation Engineers. ITE Journal, 2004, 74(4): 26.

    Google Scholar 

  11. N. U.S. Dept. Transp. Fatality analysis reporting system (FARS): Analytical user’s manual 1975–2015, USA, Tech. Rep. DOT HS, 2016: Tech. Rep. DOT HS 812 315.

  12. N. U.S. Dept. Transp. National automotive sampling system (NASS) general estimates system (GES): Analytical user’s manual 1988–2015, USA, Tech. Rep. DOT HS, 2016: Tech. Rep. DOT HS 812 320.

  13. J M Scanlon, R Sherony, H C Gabler. Models of driver acceleration behavior prior to real-world intersection crashes. IEEE Transactions on Intelligent Transportation Systems, 2017, 19(3): 774–786.

    Google Scholar 

  14. K Dresner, P Stone. A multiagent approach to autonomous intersection management. Journal of Artificial Intelligence Research, 2008, 31: 591–656.

    Google Scholar 

  15. C Sun, Z Deng, W Chu, et al. Acclimatizing the operational design domain for autonomous driving systems. IEEE Intelligent Transportation Systems Magazine, 2021.

  16. Y Guo, J Ma, C Xiong, et al. Joint optimization of vehicle trajectories and inter- section controllers with connected automated vehicles: Combined dynamic programming and shooting heuristic approach. Transportation Research Part C: Emerging Technologies, 2019, 98: 54–72.

    Google Scholar 

  17. J Zhao, V L Knoop, M Wang. Two-dimensional vehicular movement modelling at intersections based on optimal control. Transportation Research Part B: Methodological, 2020, 138: 1–22.

    Google Scholar 

  18. R Tachet, P Santi, S Sobolevsky, et al. Revisiting Street intersections using slot-based systems. PloS One, 2016, 11(3): e0149607.

  19. M Kneissl, A K Madhusudhanan, A Molin, et al. A multi-vehicle control framework with application to automated valet parking. IEEE Transactions on Intelligent Transportation Systems, 2020.

  20. M Kloock, P Scheffe, S Marquardt, et al. Distributed model predictive intersection control of multiple vehicles. 2019 IEEE intelligent Transportation Systems Conference (ITSC), IEEE, 2019: 1735–1740.

    Google Scholar 

  21. G Li, Y Yang, T Zhang, X Qu, et al. Risk assessment based collision avoidance decision-making for autonomous vehicles in multi- scenarios. Transportation Research Part C: Emerging Technologies, 2021, 122: 102820.

  22. W Zhao, R Liu, D Ngoduy. A bilevel programming model for autonomous intersection control and trajectory planning. Transportmetrica A: Transport Science, 2021, 17(1): 34–58.

    Google Scholar 

  23. Y Feng, D He, Y Guan. Composite platoon trajectory planning strategy for intersection throughput maximization. IEEE Transactions on Vehicular Technology, 2019, 68(7): 6305–6319.

    Google Scholar 

  24. K Yang, X Tang, Y Qin, et al. Comparative study of trajectory tracking control for automated vehicles via model predictive control and robust h-infinity state feedback control. Chinese Journal of Mechanical Engineering, 2021, 34: 74, https://doi.org/10.1186/s10033-021-00590-3.

    Article  Google Scholar 

  25. B Liu, Q Shi, Z Song, et al. Trajectory planning for autonomous intersection management of connected vehicles. Simulation Modelling Practice and Theory, 2019, 90: 16–30.

    Google Scholar 

  26. Y Liu, U Ozguner. Human driver model and driver decision making for intersection driving. 2007 IEEE Intelligent Vehicles Symposium, IEEE, 2007: 642– 647.

    Google Scholar 

  27. X Lin, J Zhang, J Shang, et al. Decision making through occluded intersections for autonomous driving. 2019 IEEE Intelligent Transportation Systems Conference (ITSC), IEEE, 2019: 2449–2455.

    Google Scholar 

  28. B Xu, X J Ban, Y Bian, et al. Cooperative method of traffic signal optimization and speed control of connected vehicles at isolated intersections. IEEE Transactions on Intelligent Transportation Systems, 2018, 20(4): 1390–1403.

    Google Scholar 

  29. W Zhao, D Ngoduy, S Shepherd, et al. A platoon based cooperative eco-driving model for mixed automated and human-driven vehicles at a signalised intersection. Transportation Research Part C: Emerging Technologies, 2018, 95: 802–821.

    Google Scholar 

  30. J Ma, X Li, F Zhou, et al. Parsimonious shooting heuristic for trajectory design of connected automated traffic part ii: Computational issues and optimization. Transportation Research Part B: Methodological, 2017, 95: 421–441.

    Google Scholar 

  31. Y Guan, Y Ren, S E Li, et al. Centralized cooperation for connected and auto- mated vehicles at intersections by proximal policy optimization. IEEE Transactions on Vehicular Technology, 2020, 69(11): 12597–12608.

    Google Scholar 

  32. G Li, S Li, S Li, et al. Deep reinforcement learning enabled decision-making for autonomous driving at intersections. Automotive Innovation, 2020, 3(4): 374–385.

    Google Scholar 

  33. S M LaValle. Rapidly-exploring random trees: A new tool for path planning. Technical Report, TR98-11, Ames, USA: Department of Computer Science, Iowa State University, 1998.

  34. S Karaman, E Frazzoli. Sampling-based algorithms for optimal motion planning. The International Journal of Robotics Research, 2011, 30(7): 846–894.

    MATH  Google Scholar 

  35. Y Kuwata, J Teo, S Karaman, et al. Motion planning in complex environments using closed-loop prediction. AIAA Guidance, Navigation and Control Conference and Exhibit, 2008: 7166.

  36. D J Webb, J Van Den Berg. Kinodynamic rrt*: Asymptotically optimal motion planning for robots with linear dynamics. 2013 IEEE International Conference on Robotics and Automation, IEEE, 2013: 5054–5061.

  37. L Ma, J Xue, K Kawabata, et al. Efficient sampling-based motion planning for on-road autonomous driving. IEEE Transactions on Intelligent Transportation Systems, 2015, 16(4): 1961–1976.

    Google Scholar 

  38. C Chen, M Rickert, A Knoll. Combining task and motion planning for intersection assistance systems. 2016 IEEE Intelligent Vehicles Symposium (IV), IEEE, 2016: 1242–1247.

    Google Scholar 

  39. S Yoon, D Lee, J Jung, et al. Spline-based rrt* using piecewise continuous collision-checking algorithm for car-like vehicles,” Journal of Intelligent & Robotic Systems, 2018, 90(3): 537–549.

    Google Scholar 

  40. S S Mehta, C Ton, M J McCourt, et al. Human-assisted rrt for path planning in urban environments. 2015 IEEE International Conference on Systems, Man, and Cybernetics, IEEE, 2015: 941–946.

  41. A Zyner, S Worrall, E Nebot. Naturalistic driver intention and path prediction using recurrent neural networks. IEEE Transactions on Intelligent Transportation Systems, 2019.

  42. D J Phillips, T A Wheeler, M J Kochenderfer. Generalizable intention prediction of human drivers at intersections. 2017 IEEE Intelligent Vehicles Symposium (IV), IEEE, 2017: 1665–1670.

    Google Scholar 

  43. A Zyner, S Worrall, E Nebot. A recurrent neural network solution for predicting driver intention at unsignalized intersections. IEEE Robotics and Automation Letters, 2018, 3(3): 1759–1764.

    Google Scholar 

  44. X Huang, S G McGill, B C Williams, et al. Uncertainty-aware driver trajectory prediction at urban intersections. 2019 International Conference on Robotics and Automation (ICRA), IEEE, 2019: 9718–9724.

  45. D Roy, T Ishizaka, C K Mohan, et al. Vehicle trajectory prediction at intersections using interaction based generative adversarial networks. 2019 IEEE Intelligent Transportation Systems Conference (ITSC), IEEE, 2019: 2318–2323.

    Google Scholar 

  46. M S Shirazi, B T Morris. Trajectory prediction of vehicles turning at intersections using deep neural networks. Machine Vision and Applications, 2019, 30(6): 1097–1109.

    Google Scholar 

  47. S Lefe`vre, D Vasquez, C Laugier. A survey on motion prediction and risk assessment for intelligent vehicles. ROBOMECH Journal, 2014, 1(1): 1.

  48. J Zhang, G Li, Z Deng, et al. Interaction-aware cut-in behavior prediction and risk assessment for autonomous driving. IFAC- PapersOnLine, 2020, 53(5): 656–663.

    Google Scholar 

  49. Y Jeong, K Yi, S Park. SVM based intention inference and motion planning at uncontrolled intersection. IFAC-PapersOnLine, 2019, 52(8): 356–361.

    Google Scholar 

  50. Y Jeong, S Kim, K Yi. Surround vehicle motion prediction using LSTM-RNN for motion planning of autonomous vehicles at multi-lane turn intersections. IEEE Open Journal of Intelligent Transportation Systems, 2020, 1: 2–14.

    Google Scholar 

  51. Y Wang, Z Liu, Z Zuo, et al. Trajectory planning and safety assessment of autonomous vehicles based on motion prediction and model predictive control. IEEE Transactions on Vehicular Technology, 2019, 68(9): 8546–8556.

    Google Scholar 

  52. T Zhang, W Song, M Fu, et al. Vehicle motion prediction at intersections based on the turning intention and prior trajectories model. IEEE/CAA Journal of Automatica Sinica, 2021.

  53. P Falcone, F Borrelli, H E Tseng, et al. A hierarchical model predictive control framework for autonomous ground vehicles. 2008 American Control Conference, IEEE, 2008: 3719–3724.

    Google Scholar 

  54. P Polack, F Altché, B d’Andréa-Novel, et al. The kinematic bicycle model: A consistent model for planning feasible trajectories for autonomous vehicles? 2017 IEEE Intelligent Vehicles Symposium (IV), IEEE, 2017: 812–818.

    Google Scholar 

  55. F Altche´, P Polack, A de La Fortelle. High-speed trajectory planning for autonomous vehicles using a simple dynamic model. 2017 IEEE 20th International Conference on Intelligent Transportation Systems (ITSC), IEEE, 2017: 1–7.

  56. Y Rasekhipour. Prioritized obstacle avoidance in motion planning of autonomous vehicles, 2017.

  57. G Schildbach, M Soppert, F Borrelli. A collision avoidance system at intersections using robust model predictive control. 2016 IEEE Intelligent Vehicles Symposium (IV), IEEE, 2016: 233–238.

    Google Scholar 

  58. R Hult, M Zanon, S Gros, et al. Optimal coordination of automated vehicles at intersections: Theory and experiments. IEEE Transactions on Control Systems Technology, 2018, 27(6): 2510–2525.

    Google Scholar 

  59. J Nilsson, M Bra¨nnstro¨m, J Fredriksson, et al. Longitudinal and lateral control for automated yielding maneuvers. IEEE Transactions on Intelligent Transportation Systems, 2016, 17(5): 1404–1414.

  60. C Liu, S Lee, S Varnhagen, et al. Path planning for autonomous vehicles using model predictive control. 2017 IEEE Intelligent Vehicles Symposium (IV), IEEE, 2017: 174–179.

    Google Scholar 

  61. C Liu, W Zhan, M Tomizuka. Speed profile planning in dynamic environments via temporal optimization. 2017 IEEE Intelligent Vehicles Symposium (IV), IEEE, 2017: 154–159.

    Google Scholar 

  62. J Moreau, P Melchior, S Victor, et al. Reactive path planning for autonomous vehicle using Be´zier curve optimization. 2019 IEEE Intelligent Vehicles Symposium (IV), IEEE, 2019: 1048–1053.

    Google Scholar 

  63. J Moreau, P Melchior, S Victor, et al. Reactive path planning in intersection for autonomous vehicle. IFAC-PapersOnLine, 2019, 52(5): 109–114.

    Google Scholar 

  64. S Hecker, D Dai, L Van Gool. End-to-end learning of driving models with surround-view cameras and route planners. Proceedings of the European Conference on Computer Vision (ECCV), 2018: 435–453.

  65. W Zeng, W Luo, S Suo, et al. End-to-end interpretable neural motion planner. Proceedings of the IEEE/CVF Conference on Computer Vision and Pattern Recognition, 2019: 8660–8669.

  66. M Bouton, A Nakhaei, K Fujimura, et al. Safe reinforcement learning with scene decomposition for navigating complex urban environments. 2019 IEEE Intelligent Vehicles Symposium (IV), IEEE, 2019: 1469–1476.

    Google Scholar 

  67. D Kamran, C F Lopez, M Lauer, et al. Risk-aware high-level decisions for automated driving at occluded intersections with reinforcement learning. arXiv preprint arXiv:2004.04450, 2020.

  68. T Tram, A Jansson, R Gro¨nberg, et al. Learning negotiating behavior between cars in intersections using deep q-learning. 2018 21st International Conference on Intelligent Transportation Systems (ITSC), IEEE, 2018: 3169–3174.

  69. A Demir, V Sezer. Intersection navigation under dynamic constraints using deep reinforcement learning. 2018 6th International Conference on Control Engineering & Information Technology (CEIT), IEEE, 2018: 1–5.

  70. D Isele, R Rahimi, A Cosgun, et al. Navigating occluded intersections with autonomous vehicles using deep reinforcement learning. 2018 IEEE International Conference on Robotics and Automation (ICRA), IEEE, 2018: 2034–2039.

  71. Z Qiao, K Muelling, J M Dolan, et al. Automatically generated curriculum-based reinforcement learning for autonomous vehicles in urban environment. 2018 IEEE Intelligent Vehicles Symposium (IV), IEEE, 2018: 1233–1238.

    Google Scholar 

  72. D Aberdeen. A (revised) survey of approximate methods for solving partially observable Markov decision processes. Technical Report, National ICT Australia, Tech. Rep., 2003.

  73. M Bouton, A Cosgun, M J Kochenderfer. Belief state planning for autonomously navigating urban inter- sections. 2017 IEEE Intelligent Vehicles Symposium (IV), IEEE, 2017: 825–830.

    Google Scholar 

  74. C Hubmann, M Becker, D Althoff, et al. Decision making for autonomous driving considering interaction and uncertain prediction of sur- rounding vehicles. 2017 IEEE Intelligent Vehicles Symposium (IV), IEEE, 2017: 1671–1678.

    Google Scholar 

  75. C Hubmann, J Schulz, M Becker, et al. Automated driving in uncertain environments: Planning with interaction and uncertain maneuver prediction. IEEE Transactions on Intelligent Vehicles, 2018, 3(1): 5–17.

    Google Scholar 

  76. K Shu, H Yu, X Chen, et al. Autonomous driving at intersections: A behavior-oriented critical-turning-point approach for decision making. IEEE/ASME Transactions on Mechatronics, 2021.

  77. K Shu, H Yu, X Chen, et al. Autonomous driving at intersections: a critical- turning-point approach for left turns. 2020 IEEE 23rd International Conference on Intelligent Transportation Systems (ITSC), IEEE, 2020: 1–6.

  78. C Hubmann, N Quetschlich, J Schulz, et al. A pomdp maneuver plan- ner for occlusions in urban scenarios. 2019 IEEE Intelligent Vehicles Symposium (IV), IEEE, 2019: 2172–2179.

    Google Scholar 

  79. S Brechtel, T Gindele, R Dillmann. Probabilistic decision-making under uncertainty for autonomous driving using continuous POMDPs. 17th International IEEE Conference on Intelligent Transportation Systems (ITSC), IEEE, 2014: 392–399.

  80. B De Schutter, d B De Moor. Optimal traffic light control for a single intersection. European Journal of Control, 1998, 4(3): 260–276.

  81. E Bingham. Reinforcement learning in neurofuzzy traffic signal control. European Journal of Operational Research, 2001, 131(2): 232–241.

    MATH  Google Scholar 

  82. M Wiering. Multi-agent reinforcement learning for traffic light control. Machine Learning: Proceedings of the Seventeenth International Conference (ICML’2000), Stanford, CA, USA: Morgan Kaufmann, 2000: 1151–1158.

  83. B Abdulhai, R Pringle, G J Karakoulas. Reinforcement learning for true adaptive traffic signal control. Journal of Transportation Engineering, 2003, 129(3): 278–285.

    Google Scholar 

  84. D Houli, L Zhiheng, Z Yi. Multiobjective reinforcement learning for traffic signal control using vehicular ad hoc network. EURASIP Journal on Advances in Signal Processing, 2010: 7.

  85. B Asadi, A Vahidi. Predictive cruise control: Utilizing upcoming traffic signal information for improving fuel economy and reducing trip time. IEEE Transactions on Control Systems Technology, 2010, 19(3): 707–714.

    Google Scholar 

  86. B Xu, X J Ban, Y Bian, et al. V2I based cooperation between traffic signal and approaching automated vehicles. 2017 IEEE Intelligent Vehicles Symposium (IV), California, USA: IEEE, 2017: 1658–1664.

  87. L Li, F-Y Wang. Cooperative driving at blind crossings using intervehicle communication. IEEE Transactions on Vehicular Technology, 2006, 55(6): 1712–1724.

    Google Scholar 

  88. Y Meng, L Li, F-Y Wang, et al. Analysis of cooperative driving strategies for nonsignalized intersections. IEEE Transactions on Vehicular Technology, 2017, 67(4): 2900–2911.

    Google Scholar 

  89. K Dresner, P Stone. Multiagent traffic management: A reservation-based intersection control mechanism. Autonomous Agents and Multiagent Systems, International Joint Conference on, IEEE Computer Society, 2004: 530–537.

  90. A A Malikopoulos, C G Cassandras, Y J Zhang. A decentralized energy-optimal control framework for connected automated vehicles at signal-free intersections. Automatica, 2018, 93: 244–256.

    MathSciNet  MATH  Google Scholar 

  91. Q Jin, G Wu, K Boriboonsomsin, et al. Platoon-based multi-agent intersection management for connected vehicle. 16th International IEEE Conference on Intelligent Transportation Systems (ITSC 2013), IEEE, 2013: 1462–1467.

  92. B Filocamo, J A Ruiz, M A Sotelo. Efficient management of road intersections for automated vehicles—the frfp system applied to the various types of intersections and roundabouts. Applied Sciences, 2020, 10(1): 316.

    Google Scholar 

  93. Q Lu, K-D Kim. Intelligent intersection management of autonomous traffic using discrete-time occupancies trajectory. Journal of Traffic and Logistics Engineering, 2016, 4(1): 1–6.

    Google Scholar 

  94. H Xu, Y Zhang, L Li, et al. Cooperative driving at unsignalized intersections using tree search. IEEE Transactions on Intelligent Transportation Systems, 2019, 21(11): 4563–4571.

    Google Scholar 

  95. S I Guler, M Menendez, L Meier. Using connected vehicle technology to improve the efficiency of intersections. Transportation Research Part C: Emerging Technologies, 2014, 46: 121–131.

    Google Scholar 

  96. K Yang, S I Guler, M Menendez. Isolated intersection control for various levels of vehicle technology: Conventional, connected, and automated vehicles. Transportation Research Part C: Emerging Technologies, 2016, 72: 109–129.

    Google Scholar 

  97. M A Guney, I A Raptis. Scheduling-based optimization for motion coordination of autonomous vehicles at multilane intersections. Journal of Robotics, 2020.

  98. Q Lu, K-D Kim. A mixed integer programming approach for autonomous and connected intersection crossing traffic control. 2018 IEEE 88th Vehicular Technology Conference (VTC-Fall), IEEE, 2018: 1–6.

    Google Scholar 

  99. C Liu, C-W Lin, S Shiraishi, et al. Distributed conflict resolution for connected autonomous vehicles. IEEE Transactions on Intelligent Vehicles, 2017, 3(1): 18–29.

    Google Scholar 

  100. M Bashiri, C H Fleming. A platoon-based inter- section management system for autonomous vehicles. 2017 IEEE Intelligent Vehicles Symposium (IV), IEEE, 2017: 667–672.

    Google Scholar 

  101. R Timmerman, M A Boon. Platoon forming algorithms for intelligent street intersections. Transportmetrica A: Transport Science, 2021, 17(3): 278–307.

    Google Scholar 

  102. K Pandit, D Ghosal, H M Zhang, et al. Adaptive traffic signal control with vehicular ad hoc networks. IEEE Transactions on Vehicular Technology, 2013, 62(4): 1459–1471.

    Google Scholar 

  103. A Dey, A Pal. Fuzzy graph coloring technique to classify the accidental zone of a traffic control. Annals of Pure and Applied Mathematics, 2013, 3(2): 169–178.

    Google Scholar 

  104. Y-T Lin, H Hsu, S-C Lin, et al. Graph-based modeling, scheduling, and verification for intersection management of intelligent vehicles. ACM Transactions on Embedded Computing Systems (TECS), 2019, 18(5s): 1–21.

    Google Scholar 

  105. Z Deng, Y Shi, Q Han, et al. A conflict duration graph-based coordination method for connected and automated vehicles at signal-free intersections. Applied Sciences, 2020, 10(18): 6223.

    Google Scholar 

  106. H Ahn, D Del Vecchio. Safety verification and control for collision avoidance at road intersections. IEEE Transactions on Automatic Control, 2017, 63(3): 630–642.

    MathSciNet  MATH  Google Scholar 

  107. H Ahn, A Colombo. Abstraction-based safety verification and control of cooperative vehicles at road intersections. IEEE Transactions on Automatic Control, 2019.

  108. D Miculescu, S Karaman. Polling-systems-based autonomous vehicle coordination in traffic intersections with no traffic signals. IEEE Transactions on Automatic Control, 2019, 65(2): 680–694.

    MathSciNet  MATH  Google Scholar 

  109. C Chen, Q Xu, M Cai, et al. A graph-based conflict-free cooperation method for intelligent electric vehicles at unsignalized intersections. arXiv preprint arXiv:2103.14290, 2021.

  110. C Chen, Q Xu, M Cai, et al. Conflict-free cooperation method for connected and automated vehicles at unsignalized intersections: Graph-based modeling and optimality analysis. arXiv preprint arXiv:2107.07179, 2021.

  111. V Milane´s, J Pe´rez, E Onieva, et al. Controller for urban intersections based on wireless communications and fuzzy logic. IEEE Transactions on Intelligent Transportation Systems, 2010, 11(1): 243–248.

  112. E Onieva, V Milane´s, J Villagra, et al. Genetic optimization of a vehicle fuzzy decision system for intersections. Expert Systems with Applications, 2012, 39(18): 13148–13157.

  113. Y J Zhang, A A Malikopoulos, C G Cassandras. Optimal control and coordination of connected and automated vehicles at urban traffic intersections. 2016 American Control Conference (ACC), IEEE, 2016: 6227–6232.

    Google Scholar 

  114. Y Zhang, A A Malikopoulos, C G Cassandras. Decentralized optimal control for connected automated vehicles at intersections including left and right turns. 2017 IEEE 56th Annual Conference on Decision and Control (CDC), IEEE, 2017: 4428–4433.

  115. Y Zhang, C G Cassandras, A A Malikopoulos. Optimal control of connected automated vehicles at urban traffic intersections: A feasibility enforcement analysis. 2017 American Control Conference (ACC), IEEE, 2017: 3548–3553.

    Google Scholar 

  116. Y Zheng, S E Li, K Li, et al. Stability margin improvement of vehicular platoon considering undirected topology and asymmetric control. IEEE Transactions on Control Systems Technology, 2015, 24(4): 1253–1265.

    Google Scholar 

  117. H Yang, H Rakha, M V Ala. Eco-cooperative adaptive cruise control at signalized intersections considering queue effects. IEEE Transactions on Intelligent Transportation Systems, 2016, 18(6): 1575–1585.

    Google Scholar 

  118. M V Ala, H Yang, H Rakha. Modeling evaluation of eco–cooperative adaptive cruise control in vicinity of signalized intersections. Transportation Research Record, 2016, 2559(1): 108–119.

    Google Scholar 

  119. H Rakha, R K Kamalanathsharma. Eco-driving at signalized intersections using v2i communication. 2011 14th International IEEE Conference on Intelligent Transportation Systems (ITSC), IEEE, 2011: 341–346.

  120. C Sun, J Guanetti, F Borrelli, et al. Robust eco-driving control of autonomous vehicles connected to traffic lights. arXiv preprint arXiv:1802.05815, 2018.

  121. X Qi, P Wang, G Wu, et al. Connected cooperative eco-driving system considering human driver error. IEEE Transactions on Intelligent Transportation Systems, 2018, 19(8): 2721–2733.

    Google Scholar 

  122. H Jiang, J Hu, S An, et al. Eco approaching at an isolated signalized intersection under partially connected and automated vehicles environment. Transportation Research Part C: Emerging Technologies, 2017, 79: 290–307.

    Google Scholar 

  123. S E Li, S Xu, X Huang, et al. Eco-departure of connected vehicles with v2x communication at signalized intersections. IEEE Transactions on Vehicular Technology, 2015, 64(12): 5439–5449.

    Google Scholar 

  124. L Li, F-Y Wang, H Kim. Cooperative driving and lane changing at blind crossings. IEEE Proceedings Intelligent Vehicles Symposium, 2005, IEEE, 2005: 435–440.

  125. L Li, F-Y Wang, Y Zhang. Cooperative driving at lane closures. 2007 IEEE Intelligent Vehicles Symposium, IEEE, 2007: 1156–1161.

  126. G Lu, Y M Nie, X Liu, et al. Trajectory-based traffic management inside an autonomous vehicle zone. Transportation Research Part B: Methodological, 2019, 120: 76–98.

    Google Scholar 

  127. X Hu, J Sun. Trajectory optimization of connected and autonomous vehicles at a multilane freeway merging area. Transportation Research Part C: Emerging Technologies, 2019, 101: 111–125.

    Google Scholar 

  128. H Xu, Y Zhang, C G Cassandras, et al. A bi-level cooperative driving strategy allowing lane changes. Transportation Research Part C: Emerging Technologies, 2020, 120: 102773.

  129. C Chen, M Cai, J Wang, et al. Cooperation method of connected and automated vehicles at unsignalized intersections: Lane changing and arrival scheduling. arXiv preprint arXiv:2109.14175, 2021.

  130. Z He, L Zheng, L Lu, et al. Erasing lane changes from roads: A design of future road intersections. IEEE Transactions on Intelligent Vehicles, 2018, 3(2): 173–184.

    Google Scholar 

  131. M Cai, Q Xu, C Chen, et al. Multi-lane unsignalized intersection cooperation with flexible lane direction based on multi-vehicle formation control. arXiv preprint arXiv:2108.11112, 2021.

  132. N Mitrovic, I Dakic, A Stevanovic. Combined alternate-direction lane assignment and reservation-based intersection control. IEEE Transactions on Intelligent Transportation Systems, 2019, 21(4): 1779–1789.

    Google Scholar 

  133. J Contreras-Castillo, S Zeadally, J A Guerrero- Iban˜ez. Internet of vehicles: architecture, protocols, and security. IEEE Internet of Things Journal, 2017, 5(5): 3701–3709.

  134. J Guanetti, Y Kim, F Borrelli. Control of connected and automated vehicles: State of the art and future challenges. Annual Reviews in Control, 2018, 45: 18–40.

    MathSciNet  Google Scholar 

  135. J A Volpe. Vehicle-infrastructure integration (VII) initiative benefit-cost analysis version 2.3 (draft). National Transportation Systems Center, FHWA, 2008.

  136. Long-term development planning of automobile industry. Beijing: Tech. Rep., 2017.

  137. Y Zheng, J Wang, K Li. Smoothing traffic flow via control of autonomous vehicles. IEEE Internet of Things Journal, 2020, 7(5): 3882–3896.

    Google Scholar 

  138. C Priemer, B Friedrich. A decentralized adaptive traffic signal control using V2I communication data. 2009 12th International IEEE Conference on Intelligent Transportation Systems, St. Louis, MO, USA: IEEE, 2009: 1–6.

  139. Y Feng, C Yu, H X Liu. Spatiotemporal intersection control in a connected and automated vehicle environment. Transportation Research Part C: Emerging Technologies, 2018, 89: 364–383.

    Google Scholar 

  140. M A Salman, S Ozdemir, F V Celebi. Fuzzy logic based traffic surveillance system using cooperative V2X protocols with low penetration rate. 2017 International Symposium on Networks, Computers and Communications (ISNCC), Marrakech, Morocco: IEEE, 2017: 1–6

  141. P G Gipps. A behavioural car-following model for computer simulation. Transportation Research Part B: Methodological, 1981, 15(2): 105–111.

    Google Scholar 

  142. D Helbing, B Tilch. Generalized force model of traffic dynamics. Physical Review E, 1998, 58(1): 133.

    Google Scholar 

  143. M Treiber, A Kesting. Traffic Flow Dynamics: Data, Models and Simulation, Springer-Verlag Berlin Heidelberg, 2013.

    MATH  Google Scholar 

  144. Z Du, B HomChaudhuri, P Pisu. Coordination strategy for vehicles passing multiple signalized intersections: A connected vehicle penetration rate study. 2017 American Control Conference (ACC), IEEE, 2017: 4952–4957.

    Google Scholar 

  145. S Fang, L Yang, T Wang, et al. Trajectory planning method for mixed vehicles considering traffic stability and fuel consumption at the signalized intersection. Journal of Advanced Transportation, 2020, No. Article ID 1456207.

  146. X Liang, S I Guler, V V Gayah. Joint optimization of signal phasing and timing and vehicle speed guidance in a connected and autonomous vehicle environment. Transportation Research Record, 2019, 2673(4): 70–83.

    Google Scholar 

  147. C Chen, J Wang, Q Xu, et al. Mixed platoon control of automated and human-driven vehicles at a signalized intersection: dynamical analysis and optimal control. Transportation Research Part C: Emerging Technologies, 2021, 127: 103138.

  148. R E Stern, S Cui, M L Delle Monache, et al. Dissipation of stop-and-go waves via control of autonomous vehicles: Field experiments. Transportation Research Part C: Emerging Technologies, 2018, 89: 205–221.

  149. J Wang, Y Zheng, C Chen, et al. Leading cruise control in mixed traffic flow. Conference on Decision and Control (CDC), IEEE, 2020: 1–7.

  150. E Vinitsky, K Parvate, A Kreidieh, et al. Lagrangian control through deep-RL: Applications to bottleneck decongestion. 2018 21st International Conference on Intelligent Transportation Systems (ITSC), IEEE, 2018: 759–765.

  151. C Wu, A Kreidieh, E Vinitsky, et al. Emergent behaviors in mixed-autonomy traffic. Conference on Robot Learning, 2017: 398–407.

  152. Y Feng, K L Head, S Khoshmagham, et al. A real-time adaptive signal control in a connected vehicle environment. Transportation Research Part C: Emerging Technologies, 2015, 55: 460–473.

    Google Scholar 

  153. R Niroumand, M Tajalli, L Hajibabai, et al. The effects of the “white phase” on intersection performance with mixed-autonomy traffic stream. 2020 IEEE 23rd International Conference on Intelligent Transportation Systems (ITSC), IEEE, 2020: 1–6.

  154. Q Guo, L Li, X J Ban. Urban traffic signal control with connected and automated vehicles: A survey. Transportation Research Part C: Emerging Technologies, 2019, 101: 313–334.

    Google Scholar 

  155. Y Zhang, C G Cassandras. An impact study of integrating connected automated vehicles with conventional traffic. Annual Reviews in Control, 2019, 48: 347–356.

    MathSciNet  Google Scholar 

  156. R Niroumand, M Tajalli, L Hajibabai, et al. Joint optimization of vehicle-group trajectory and signal timing: Introducing the white phase for mixed-autonomy traffic stream. Transportation Research Part C: Emerging Technologies, 2020, 116: 102659.

  157. Y Bian, S E Li, W Ren, et al. Cooperation of multiple connected vehicles at unsignalized intersections: Distributed observation, optimization, and control. IEEE Transactions on Industrial Electronics, 2019, 67(12): 10744–10754.

    Google Scholar 

  158. C Wuthishuwong, A Traechtler, T Bruns. Safe trajectory planning for autonomous intersection management by using vehicle to infrastructure communication. EURASIP Journal on Wireless Communications and Networking, 2015, 1: 1–12.

    Google Scholar 

  159. F Perronnet, A Abbas-Turki, A El Moudni. A sequenced-based protocol to manage autonomous vehicles at isolated intersections. 16th International IEEE Conference on Intelligent Transportation Systems (ITSC 2013), IEEE, 2013: 1811–1816.

  160. O A Mahmood, A Khakimov, A Muthanna, et al. Effect of heterogeneous traffic on quality of service in 5G network. International Conference on Distributed Computer and Communication Networks, Springer, 2019: 469–478.

  161. M Beshley, N Kryvinska, M Seliuchenko, et al. End-to-end qos “smart queue” management algorithms and traffic prioritization mechanisms for narrow-band internet of things services in 4G/5G networks. Sensors, 2020, 20(8): 2324.

    Google Scholar 

  162. M A Rodriguez-Hernandez, A Gomez-Sacristan, D Gomez-Cuadrado. Simulcity: Planning communications in smart cities. IEEE Access, 2019, 7: 46870–46884.

    Google Scholar 

  163. Y Liu, Z Nicolai-Scanio, Z-P Jiang, et al. Latency-robust control of high-speed signal-free intersections. 2021 American Control Conference (ACC), IEEE, 2021: 2935–2942.

    Google Scholar 

  164. Y V Tan, M R Elliott, C A Flannagan. Development of a real-time prediction model of driver behavior at intersections using kinematic time series data. Accident Analysis & Prevention, 2017, 106: 428–436.

    Google Scholar 

  165. B K Pathivada, V Perumal. Analyzing dilemma driver behavior at signalized intersection under mixed traffic conditions. Transportation Research part F: Traffic Psychology and Behaviour, 2019, 60: 111–120.

    Google Scholar 

  166. Q Liu, S Hu, P Angeloudis, et al. Simulation and evaluation of CAVs behavior in an isolated signalized intersection equipped with dynamic wireless power transfer system. 2019 IEEE Intelligent Transportation Systems Conference (ITSC), IEEE, 2019: 2207–2212.

    Google Scholar 

  167. M Zhou, Y Yu, X Qu. Development of an efficient driving strategy for connected and automated vehicles at signalized intersections: A reinforcement learning approach. IEEE Transactions on Intelligent Transportation Systems, 2019, 21(1): 433–443.

    Google Scholar 

  168. H B Almobayedh, D Eustace, P Appiah-Kubi. Simulation of the impact of connected and automated vehicles at a signalized intersection. 2019 Road Safety & Simulation International Conference, 2019.

  169. R Arvin, A J Khattak, M Kamrani, et al. Safety evaluation of connected and automated vehicles in mixed traffic with conventional vehicles at intersections. Journal of Intelligent Transportation Systems, 2020, 25(2): 170–187.

    Google Scholar 

  170. K-H N Bui, J J Jung. Cooperative game theoretic approach to traffic flow optimization for multiple intersections. Computers & Electrical Engineering, 2018, 71: 1012–1024.

    Google Scholar 

  171. Y Zhang, Y Zhou. Distributed coordination control of traffic network flow using adaptive genetic algorithm based on cloud computing. Journal of Network and Computer Applications, 2018, 119: 110–120.

    Google Scholar 

  172. A Jovanovic´, D Teodorovic´. Multi-objective optimization of a single intersection. Transportation Planning and Technology, 2021, 44(2): 139–159.

  173. J Wang, X Zhao, G Yin. Multi-objective optimal cooperative driving for connected and automated vehicles at non-signalised intersection. IET Intelligent Transport Systems, 2019, 13(1): 79–89.

    Google Scholar 

  174. P Paquette, Y Lu, S Bocco, et al. No press diplomacy: modeling multiagent gameplay. arXiv preprint arXiv:1909.02128, 2019.

  175. S Li, K Shu, Y Zhou, et al. Cooperative critical turning point-based decision-making and planning for CAVH intersection management system. IEEE Transactions on Intelligent Transportation Systems, 2021.

  176. H Preston, R Storm, M Donath, et al. Review of Minnesota’s rural intersection crashes: Methodology for identifying intersections for intersection decision support (ids), 2004.

  177. W-J Wu, Z-C Juan, H-F Jia. Drivers’ behavioral decision-making at signalized intersection with countdown display unit. Systems Engineering-Theory& Practice, 2009, 29(7): 160–165.

    Google Scholar 

  178. C Sun, J M U Vianney, Y Li, et al. Proximity based automatic data annotation for autonomous driving. IEEE/CAA Journal of Automatica Sinica, 2020, 7(2): 395–404.

    Google Scholar 

  179. W Zhan, L Sun, D Wang, et al. Interaction dataset: An international, adversarial and cooperative motion dataset in interactive driving scenarios with semantic maps. arXiv preprint arXiv:1910.03088, 2019.

  180. R Krajewski, J Bock, L Kloeker, et al. The highd dataset: A drone dataset of naturalistic vehicle trajectories on German highways for validation of highly automated driving systems. 2018 21st International Conference on Intelligent Transportation Systems (ITSC), IEEE, 2018: 2118–2125.

  181. J Bock, R Krajewski, T Moers, et al. The inD dataset: A drone dataset of naturalistic road user trajectories at German intersections. arXiv e-prints, 2019.

Download references

Acknowledgements

Not applicable.

Funding

Not applicable.

Author information

Authors and Affiliations

Authors

Contributions

SL and DC were in charge of the whole trial. SL, KS, and CC performed the review and wrote the manuscript. SL proposed the main idea of the article. KS and CC helped to check and revise the manuscript. All authors read and approved the final manuscript.

Authors’ Information

Shen Li received the Ph.D. degree from University of Wisconsin, Madison, USA, in 2018. He is currently a research associate at Tsinghua University, China.

Keqi Shu is currently working on his Master degree in Applied Science in Mechanical and Mechatronics Engineering at University of Waterloo, Canada.

Chaoyi Chen, received the B.E. degree from Tsinghua University, China, in 2016, and the M.S. from Tsinghua University, China and RWTH Aachen University, Germany, in 2019. He is currently a Ph.D. candidate in mechanical engineering at School of Vehicle and Mobility, Tsinghua University, China.

Dongpu Cao received the Ph.D. degree from Concordia University, Canada, in 2008. He is the Canada Research Chair in Driver Cognition and Automated Driving, and an Associate Professor at University of Waterloo, Canada.

Corresponding author

Correspondence to Dongpu Cao.

Ethics declarations

Competing Interests

The authors declare no competing financial interests.

Rights and permissions

Open Access This article is licensed under a Creative Commons Attribution 4.0 International License, which permits use, sharing, adaptation, distribution and reproduction in any medium or format, as long as you give appropriate credit to the original author(s) and the source, provide a link to the Creative Commons licence, and indicate if changes were made. The images or other third party material in this article are included in the article's Creative Commons licence, unless indicated otherwise in a credit line to the material. If material is not included in the article's Creative Commons licence and your intended use is not permitted by statutory regulation or exceeds the permitted use, you will need to obtain permission directly from the copyright holder. To view a copy of this licence, visit http://creativecommons.org/licenses/by/4.0/.

Reprints and permissions

About this article

Check for updates. Verify currency and authenticity via CrossMark

Cite this article

Li, S., Shu, K., Chen, C. et al. Planning and Decision-making for Connected Autonomous Vehicles at Road Intersections: A Review. Chin. J. Mech. Eng. 34, 133 (2021). https://doi.org/10.1186/s10033-021-00639-3

Download citation

  • Received:

  • Revised:

  • Accepted:

  • Published:

  • DOI: https://doi.org/10.1186/s10033-021-00639-3

Keywords