A Tightly Coupled Bi-Level Coordination Framework for CAVs at Road Intersections
Abstract
Since the traffic administration at road intersections determines the capacity bottleneck of modern transportation systems, intelligent cooperative coordination for connected autonomous vehicles (CAVs) has shown to be an effective solution. In this paper, we try to formulate a Bi-Level CAVs intersection coordination framework, where coordinators from High and Low levels are tightly coupled. In the High-Level coordinator where vehicles from multiple roads are involved, we take various metrics including throughput, safety, fairness and comfort into consideration. Motivated by the time consuming space-time resource allocation framework, we try to give a low complexity solution by transforming the complicated original problem into a sequential linear programming one. Based on the “feasible tunnels” (FT) generated from the high-Level coordinator, we then propose a rapid gradient-based trajectory optimization strategy in the low-level planner, to effectively avoid collisions beyond high-level considerations, such as the unexpected pedestrian or bicycles. Simulation results and laboratory experiments show that our proposed method outperforms existing strategies. Moreover, the most impressive advantage is that the proposed strategy can plan vehicle trajectory in milliseconds, which is promising in real-world deployments. A detailed description include the coordination framework and experiment demo could be found at the supplement materials, or online at https://youtu.be/MuhjhKfNIOg.
Index Terms:
Intelligent transportation system, autonomous vehicle, intersection coordination, motion planning.I Introduction
I-A Background and Motivation
With the rapid development of modern industry and urbanization, more and more vehicles are entering the transportation system, which adds great pressure to the current road infrastructure. In most developed areas, there exists rather limited space to build extra flyovers and highways, to accommodate the rapidly increased number of vehicles. Meanwhile, many transportation related issues such as the safety, traffic congestion, fuel consumption, air pollution have become social problems, and received tremendous attention from various departments so far [1, 2, 3, 4, 5].
Since multiple roads merge at the road intersection, it has become one of the bottlenecks in modern transportation systems straightforwardly. According to reports in [6], most traffic congestion and accidents occur at road intersections. Traditional intersection coordination strategies include traffic lights, roundabouts, stop signs, etc. However, 90% of traffic accidents were related to the improper behaviors of human drivers, such as the dangerous or fatigue driving, negligence of traffic coordination signals or sudden appearance obstacles [7]. Therefore, it is of vital importance to design dedicated intersection management systems to improve traffic throughput, as well as ensuring the driving safety [8].
With the rapid development of vehicular networking technology in recent years, vehicle-to-vehicle (V2V) and vehicle-to-infrastructure (V2I) communications [9, 10] are no longer the bottleneck for multi-vehicle cooperation issues. Several studies [11, 12, 13] have showcased the immense potential of CAVs at signal-free intersections. In comparison to studies on traditional single-vehicle ego planners [14], this research explores more complex multi-vehicle planning problems. Coordinators at road intersections need to address two major issues. First, CAVs must be carefully coordinated to improve traffic throughput. Second, CAVs must perform ego motion planning based on environmental sensing to avoid collisions with accidental non-CAV obstacles, such as pedestrians, bicycles, and other non-connected vehicles.
I-B Related Work
Currently, investigations on the cooperative coordination of CAVs at road intersections can be categorized into two trends. The first trend focuses on intersection modeling and vehicle scheduling strategies, which are usually referred to as “centralized” or “high-level” planner. Another trend is the emergence of a bi-level structure built upon the centralized scheduling method. It is common for individual vehicle autonomous planners to get stuck in deadlocks [15] due to system errors. To address this issue, some authors have proposed combining the results of a high-level planner with the autonomous planner for obstacle avoidance. This approach effectively ensures system robustness and traffic safety. The former emphasizes overall coordination efficiency and computational speed, while the latter emphasizes system robustness.
These high-level planners typically possess the “global information” of the entire intersection and can be implemented on road-side units (RSUs) or other infrastructure. One early investigation, as described in [16], prohibited any two CAVs from entering the intersection simultaneously to avoid collisions. Besides safety, this coordinator also considered other metrics such as traffic throughput and fuel efficiency. This work utilized a linear maneuver model with fixed acceleration, simplifying the system formulation significantly.
To further enhance throughput, Kamal et al. introduced the concept of cross-collision points (CCPs) at road intersections [17]. Based on CCPs, Li et al. proposed a cooperative critical turning point-based decision-making algorithm [18], which modeled the coordinator as a partially observable Markov decision process (POMDP) problem to obtain the velocity of the critical turning points. However, the resulting velocity profiles were discontinuous and couldn’t be realized using practical vehicle kinematic models. Additionally, this strategy faced high computational complexity.
Other typical high-level coordinators can be found in [19, 20] and related references. These studies developed a strategy based on collision sets (CS), which is representative to formulating CS coordination as a mixed-integer programming (MIP) problem and solving it by introducing auxiliary variables[21]. Since a single CS solution was not efficient, efforts were made to extend it to a multi-collision sets (MCS) model to improve traffic capacity with a certain increase in computational time [22, 23]. Moreover, some researchers also considered the “stability” of the intersection when vehicles continuously enter the intersection queue [24], a topic rarely discussed before. What’s more, Zhang[25] provided a novel solution approach for the single CS strategy and incorporates local obstacle avoidance into the coordination of intersection control. However, in these investigations, vehicles adopted linear maneuver models, limiting the exploitation of the two-dimensional intersection’s spatial resources. In [26], the authors incorporated friction losses and power train into the kinematic models to achieve more realistic solutions. The authors of [27] proposed a method based on Deep Reinforcement Learning (DRL). This method fixes the lateral path of the vehicle and generates a speed profile. However, due to the fact that learning-based methods require a pre-determined model, this approach is not suitable for dynamic traffic environments (variable vehicle size and dynamics models). Additionally, in scenarios with a large number of vehicles, the efficiency of traffic flow can be compromised by vehicle grouping.
The second trend focuses more on system robustness, and therefore, researchers often propose a more robust double-level framework that extends the capabilities of the low-level planner for local obstacle avoidance [25]. This approach leaves some safety redundancy and effectively prevents deadlocks. To develop a more efficient coordination strategy, integrated double-level coordination frameworks were proposed in [28, 29, 30, 31]. The high-level planner generates reference trajectories and corresponding feasible tunnels, while the low-level planner, similar to single-vehicle planners, avoids nearby non-CAV obstacles within the generated FT. A novel space-time resource searching (STRS) strategy was introduced in the high-level planner. However, this method suffers from the drawback of slow computation in the high-level planner, as it involves complex dynamic programming (DP) and quadratic programming (QP). Additionally, the efficiency of the low-level planner is comparatively low, requiring a substantial number of feasible tunnels for searching viable trajectories, due to insufficient coupling with the high-level planner. Furthermore, the authors suggest that the deep reinforcement learning-based methods proposed in [27] could also be extended to enhance the capabilities of the low-level planner [14, 32] in preventing local collisions caused by errors in localization and control systems.
In addition to the aforementioned study, one major problem faced in coordination is the presence of mixed traffic flow, where both Connected Autonomous Vehicles and Manual Vehicles (MVs) coexist. In this scenario, the difficulty of overall coordination is increased due to the uncontrolled nature of MVs. Consequently, some researchers have focused on addressing this issue. Kamal et al. [33] proposed an adaptive traffic light control scheme, where the authors divided the intersection into several non-conflicting phases based on vehicle strategies. They allocated a non-conflicting green period to each vehicle according to its arrival status at the intersection. However, this method did not fully utilize the temporal and spatial resources within the intersection. Building upon the above method, Huang et al. [34] further refined the sapce-time resources within the intersection and grouped CAVs and MVs separately, introducing two specific lane restrictions. This method improves the rationality and efficiency, providing great inspiration for handling mixed traffic flow scenarios.
Some recent studies also suggest that dividing the global vehicle coordination problem into two-stages is a promising approach, namely decoupling the vehicle passage order from the specific trajectory optimization problem. For instance, in the work of Yao [35, 13], a two-stage collaborative framework for Schedule and Trajectory Optimization is proposed. This framework first employs Mixed Integer Linear Programming (MILP) based on vehicle information to determine the optimal arrival time at intersections, and then solves the trajectory optimization problem based on the results from the scheduling phase. This method effectively reduces vehicle passage delays and improves fuel efficiency. In addition, Jiang [36] further consider the time-optimal vehicle passage order. The authors employ a heuristic Monte Carlo Tree Search (MCTS) method to accelerate the solving efficiency. It is worth noting that the authors innovatively explore the impact of all-direction turn lanes (ADTL) and specific-direction turn lanes (SDTL) on the scheduling algorithm.
However, the current research in the field urgently needs a fast and tightly coupled framework that can achieve obstacle avoidance in intersection scheduling, while ensuring high robustness and efficiency. In this case, tight coupled means that the low-level planner must heavily rely on the results of the high-level planner to ensure its effectiveness. The trajectories generated by the low-level planner should aim to avoid obstacles as closely as possible to the results of the high-level planner, reducing the probability of deviating from reference trajectories of high-level planner. Excessive deviation from the reference trajectory generated by the high-level planner can potentially lead to schedule breakdown. However, the ability of such tight coupled is not adequately demonstrated in [28]. This framework should integrate high-level and low-level planners, taking into account the limitations of existing methods, such as the assumption of identical vehicle sizes, ideal communication, and control systems. It should also address the challenges posed by obstacles and control/positioning errors. To achieve high robustness and efficiency, a coordinated scheduling framework for signal-free intersections is needed.
I-C Main Contributions
Aiming at the issues on current investigations, we try to propose a low-complexity and tightly coupled bi-level coordination framework for CAVs at non-signalized road intersections. In the high-level planner, the traffic throughput, fairness and complexity are still main considerations. Unlike existing time exhausting investigations in [28], our method could significantly reduce the computing efforts. Furthermore, unlike the most existing single level coordinators, a tightly coupled low-level planner is proposed to handle non-CAV obstacles, which are not considered in the high-level planner. The main contributions can be summarized as follows.
-
•
We propose an computational efficient solution to indicate the feasible tunnels for each CAVs, which has ability to extended to various kinematics constraints and scales of CAVs. Furthermore, considering the fairness and the duration of scheduling, we give a novel benchmark of passing order priority to determine traffic sequence of vehicles.
-
•
To ensure driving safety within the “ Feasible tunnel”, we propose an effective motion plan method based on the gradient and B-spline curve. It generates the initial control points of the B-spline curve, then optimizes the control points for lower smoothness cost and avoids potential collision under the feasible tunnel constraints. Comparing to existing solutions, the tightly coupled local motion planner is more suitable to the double-level coordination framework, which could make full advantage of the result of high-level planner and higher computational efficiency.
-
•
The simulation and laboratorial experiments show that our proposed approach can effectively improve the traffic throughput. One excellent advantage is that our high-level planner has only millisecond-level latency, which means that the strategy can be deployed in real-world settings.
The rest of this paper is organized as follows: In Section II, we will explain the intersection model of our framework, vehicle kinematic model, the collision detection, construction of our framework and some state-of-art benchmark solutions for comparison. In section III, the modified coordination strategy based on space-time resource blocks is introduced. In section IV, a novel motion planner based on gradient is proposed, which is more suitable for the double-level framework. The simulation and laboratorial experiments results are demonstrated in Section V and Section VI, respectively.
II Preliminary
II-A Intersection model
We deploy a typical road intersection which consists of roads (for easy illustration, we set ), as shown in Fig. 1. The road intersection can be divided into three main sections, i.e., Waiting Area (WA), Buffer Area (BA) and Conflict Area (CA). The CA is the crucial area in our coordination framework, where potential collisions may occur. The width of lanes is , the length of BA is .

We use and to represent the sets of roads and CAVs in road , respectively. At signal-free intersections, the decision making center may face high dynamic scene, e.g., the unexpected obstacles, unsatisfactory communication and control systems. It is necessary to make following assumptions:
-
1.
Each CAVs will send its state information (position, velocity, etc.) and intention maneuvers (i.e., go straight, turn left and turn right) to the CC via vehicle-to-infrastructure links, when entering the WA. After executing the coordination framework, the CC will broadcast the coordination information (i.e. the moment of entering intersection and feasible tunnels).
-
2.
After received the coordination information, the CAVs should adjust their velocity in BA to enter the intersection at the timing that broadcasted by CC. Then CAVs travel along with the reference trajectory which is predefined, if there is no unexpected obstacles.
-
3.
Without loss of generality, the high-level planner will allocate the space-time resource blocks to every CAVs. Considering the unexpected obstacles, there should be some reasonable redundancy involved by the feasible tunnel to make sure the low-level planner has enough space to avoid collision.

II-B Vehicle Kinematic Model
In this paper, to reduce the computational complexity, we adopt the popular kinematic bicycle model [37] to describe the movement of vehicles, as shown in Fig. 2. The kinematics state of the -th vehicle in road can be described as , where , and are the position, velocity and heading in 2D Cartesian coordinate system, respectively. During the actual driving behavior, the control input are the longitudinal acceleration and the steering angle, donated by and , respectively. The vehicle kinematic state update equation is shown as following:
(1) |
where , is the distance between the front and rear wheel axles. What’s more, taking into account the kinematic constraints of the vehicle, there must have:
(2) | ||||
II-C Space Time Resource Blocks
The space-time resources was first used to describe the resources in the intersection by [28]. The resources in CA are described by three-dimensional coordinates in the , and domains. For the convenience of computation and reasonability, the space-time resources are divided into multiple blocks with the resolutions in domain, in domain, in domain. Then the resource in could be described as:
(3) |
where and are the indexs in and domains, respectively. One space-time can not be occupied by more than one vehicle simultaneously. Thus, when attempt to allocate the space-time resource in , the Centralized Coordinator must check the occupancy state of the space-time resource blocks.
The allocated area for the vehicle is represented as a collection of resource blocks, which includes not only the resource blocks occupied by the vehicle, with proper redundancy. We define the resource occupied by the -th vehicle of road as
(4) |
where represents the index set of resource blocks occupied by -th vehicle of -th road. To keep no collisions among vehicles, we need to ensure that one resource block can only be allocated to one vehicle. That means the intersection of allocated resources between the two vehicles is empty, i.e.,
(5) |
with , and .
II-D Collision Detection
In practice, there are noises in the localization [38] and control systems,
(6) |
(7) |
where and are the actual values and measured value of localization systems, respectively. and are the expected values and actual value of control systems, respectively. The CAVs always deviate from the planned trajectory. These imperfections need to be treated carefully. For the safety of vehicles, we set a redundancy around the vehicle, as shown in Fig. 3. The and represent the length and width of vehicle, respectively. The and are the longitudinal and lateral safe redundancy. The parameters of redundancy are decided by the density of obstacles and performance of control and localization system.
During the coordination process and local motion planning, the redundancy region is also considered when collision detection.

The space-time resource blocks occupied by other CAVs in time is could be considered as a occupancy grid map [39], as shown in Fig. 4. For a grid that has been occupied, it could not be occupied repeatedly, otherwise a collision will occur. In low-level planner, we assumed that the CAVs could build a Object Oriented Bounding Boxes (OOBB) topological map with the equipped sensors, then transform the OOBB map into the occupancy grid map.
In theory, redundancy is a trade-off between coordination efficiency and system robustness. Consequently, we attempt to propose a rough estimation method for redundancy size, although it should be noted that it may not be precise, through theoretical analysis. Generally, we can choose the maximum value of three times the standard deviation of the lateral and longitudinal offset errors caused by vehicle localization and control system errors as a factor to consider. In addition, unexpected obstacles within the intersection should also be taken into account. We can calculate the diameter of the circumscribed circle outside the OOBB of each obstacles as another statistical factor, which can be observed by CC. Although the obstacles may not be located on the boundary of the feasible path, which may cause the vehicles to deviate from their intended trajectories to go around the obstacles, the system is able to handle such deviations to a certain extent due to the robustness of the low-level planner. Finally, we define a rough formula for calculating the redundancy size of feasible tunnel:
(8) |
where and are the variances of the lateral and longitudinal tracking errors due to the subpar localization and control system, respectively, is the diameter of the circumscribed circle outside the bounding box of the obstacle.
In both High-Level and low-level planners, we calculate the grids that occupied by CAVs and obstacles, respectively. For collision free, there can not be any overlaps of allocated grids.


II-E Structure of the Coordination Framework
The double-level coordination framework can be divided into two parts, as depicted in Fig. 5. The functions of two parts are as following.
-
1.
high-level planner (coordination strategy): After the CAVs entering the WA, the CC attempts to receive the their information about positions, velocity, intention maneuvers and the like by V2I (Vehicle to infrastructure) links. According to road information of the intersection, the CC generates the reference trajectories for each CAV. After calculated the traffic priority of the first CAVs in each road, the CC executes coordination strategy to get the reference trajectories and feasible tunnels of the waiting CAVs.
-
2.
Low-level planner (local motion planner): Based on the reference trajectory generated by the high-level planner, the low-level planner attempts to optimize the trajectory to avoid collisions within the feasible tunnel. The practice trajectory also needs to be sufficiently smooth and feasible in terms of kinematics model. What’s more, an unexceptionable controller also plays an important role in the frame, and lower control errors can reduce the probability of collisions. It is worth noting that the low-level planner is executed by CAVs based on local perception information and, therefore, does not occupy resources of the central coordinator.
II-F Benchmark Solutions
In this subsection, we briefly introduce some state-of-art benchmark solutions of coordination strategy in intersection for comparison.
II-F1 Collision Set
The area where exists potential collision is defined as a collision set in Collision Set strategy [25], that means one collision set can not be occupied by multiple CAVs simultaneously, the CAVs are only allowed to pass through the intersection one after the other. Although the CS strategy shows preponderance in terms of long-term stability and relative low-complexity implementation, if cannot tap the full potential of the intersection. The high-level planner in [28], the authors imporved the CS strategy for better performance. Thus, we regard the CS strategy proposed by [28] as our benchmark for comparison.
II-F2 Space-Time-Block Searching
[28] proposed a novel and aggressive space-time resource searching strategy. For maximum pass throughput, multiple CAVs can share the intersection simultaneously. The space-time resource is divided into many blocks which can be regarded as three-dimensional coordinates with , , and domains. Based on the reference path, CC searches the velocity profiles of CAVs in ST domains to guarantee comfort and safety. Due the transition of resources between XYT domains and ST domains, this strategy could get the optimal trajectory at the expense of high computation complexity. In comparison to CS strategy, STRS still shows a obvious throughput advantages. In addition, STRS strategy can not operate in real-time, and the computational complexity grows exponentially.
III high-level planner
The structure of the entire high-level planner is shown in Fig. 6. Firstly, we generate reference trajectories of different CAVs according to their kinematic constraints by Reference Trajectory Generator. We can obtain the reasonable timing of CAVs to enter the intersection by the core module of our proposed, then the CC determines the current round passage CAV by comparing the priority of CAVs, and allocates its feasible tunnel to complete the current round of coordination. As the result of the high-level planner is the timing of the CAV to enter the Conflict Area, the trajectory between the Waiting Area and the Conflict Area needs to be calculated finally. We’ll introduce each of the modules mentioned above.

III-A Reference Trajectory Generator
The simplified line circle path [40] is one popular option. However, it is too ideal to be realized in the kinematic bicycle model due to the discontinuous second order derivative. In the three-dimensional Cartesian coordinates system XYT, the trajectory can be decoupled as Path and Speed Profile [41]. Usually, the trajectory can be expressed as
(9) |
where is the arc length along with the path, is decided by velocity and acceleration of vehicle.
In order to make the path smooth and subject to the kinematics constraints, the problem can be built as a constrained optimization problem, one key constraint is the continuity of trajectories [25].
(10) |
where and are the start and end position of standard line circle path, respectively. is the total length of standard path.
In order to make the reference trajectory more consistent with traffic rules and human driving habits, the distance limitation between the actual path and the standard line circle path is also a necessary constraint.
(11) |
where are the equally spaced sample points on standard line circle path. is the number of sample points, which is decided by . is the distance limitation between reference and standard line circle paths.
Therefore, the optimization problem can be expressed as
(12) | ||||
s.t. |
where means the -th order derivative of .
Generally, the quintic polynomial is a good way to express the trajectory, then can be formulated as a typical quadratic programming problem [42], and solved by off-the-shelf solvers rapidly.
Since the length of entire standard line circle path will be changed after planning, we propose a method to generate speed profiles rapidly for the higher fuel efficiency [19] and comfort. Ideally, we want the vehicle to cross the intersection with a speed close to the reference speed without any accelerations. After solving the reference path, we can obtain the length of the reference path , thus the longitudinal displacement can be expressed as
(13) |
which is the integral of velocity, also means the longitudinal travel distance along the reference path.
III-B Problem Formulation
The high-level planner of STRS strategy can not solute in real-time, because of the high computation complexity. In order to apply the double-level framework based on space-time resource block to multi-roads intersection, we improved the model to overcome the high computation complexity and propose a new high-level planner to achieve feasible tunnel allocation for higher efficiency in traffic utilization.
First, the CC should calculate the reference trajectory for each vehicle. Specially, the potential collision exists in the Conflict Area, so we only consider the reference trajectory between the vehicle and redundancy entering the Conflict Area and leaving the Conflict Area. Then, the reference trajectory of -th vehicle in road can be represented as following,
(14) |
where and are the road which the vehicle come from and intend to reach, respectively. Specifically, is the maneuver (turn left, go straight, turn right) of the vehicle, that means road must be one of the feasible roads, which vehicle came from road and maneuvered as could reach. and are the moments of entering the Conflict Area and the duration of the specified reference trajectory, respectively. We can calculate the index set of resource blocks occupied by vehicle at time state directly.
Generally, the index set of occupied resource block of each trajectory starting at time are represented as
(15) |
where means the round down of . means the index set of resource blocks which are occupied vehicle with state at time . Because the starting time of reference trajectory provided by Reference Trajectory Generator is , the time index of reference trajectory index set must be added with a time offset .
III-C Single Lane Circumstance
When there’s only one road need to be coordinated, CAVs could only enter the intersection one by one. Thus, we should indicate the timing of entering the intersection for each CAVs.
At -th round, the index set of space-time resource blocks occupied in previous rounds can be expressed as . Particularly, in the first round. For potential collisions avoidance, we need to guarantee that the same resource block cannot be occupied repeatedly, i.e.,
(16) |
At -th round, the resource that allocated to the -th CAV in -th road can be represented by . After -th round, should be updated.
(17) |
Thus, the resource allocation problem can be described as a typical linear programming problem:
(18) | ||||
s.t. |
where represents the index set of resource blocks occupied during the whole scheduling process.
The aforementioned method can determine the optimal timing for a CAV to enter the intersection in a single-lane scenario. However, in a multi-lane intersection, there are multiple lanes to consider, which means we must select a CAV to enter the intersection first and then consider the subsequent CAVs in the next round of coordination. This implies that the problem can be solved using sliding window method, also means receding horizon control.
III-D Priority of CAVs
Due to the potential presence of multiple vehicles waiting to pass at an intersection, it is necessary to determine the sequence of vehicle movements, which signifies the need to assign a priority, known as right of way, to each vehicle. That implies the optimization objective of the problem will change. We need to consider multiple optimization objectives, rather than solely focusing on traffic efficiency. First and foremost, based on the resource blocks allocated to CAV, the passing priority term of traffic efficiency could be defined as
(19) |
The general intersection coordination strategy all aim to maximize throughput, that can lead to unfair situations where the first CAV at some roads cannot be scheduled for a long time. [28] also ensures the fairness of the passage by introducing resource occupancy rate term into the performance criteria of the coordination. Nevertheless, vehicles going straight tend to increase resource occupancy rate more than turning left in most cases. In practice, the reasonableness of this item is debatable. An effective approach is to add waiting time term to the performance criteria of the coordination for fairness of passage.
(20) |
where indicates the waiting time at -th in road queue.
For queue stability [43], according to Lyapunov theorem, we should ensure the following equation holds,
(21) |
where is the length of -th road at .
Thus the performance criteria about queue stability can be defined as:
(22) |
where represents the arrive rate of -th road.
In every round, we could select the optimal vehicle in all road to pass base on priority of vehicle function, i.e.,
(23) |
where, we neglected the inclusion of the factor proposed in [28] due to its high coupling with factor. Specially, must be the first vehicle in all road queue in this round.
The algorithm flow of the entire high-level planner is shown in Algorithm 1.
IV low-level planner
For CAVs, there exist various random obstacles, such as pedestrians, bicycles, etc. They usually cannot be accurately tracked or predicted by road infrastructures, so such obstacles cannot be considered in the high-level planner. In addition, due to imperfect control and localization operations, CAVs may move out of their feasible tunnel and collide with other CAVs. The CAVs need to characterize obstacles and the environment to generate the actual trajectory based on the reference trajectory and feasible tunnel provided by high-level planner.
The reference trajectory provided by high-level planner is optimal in terms of smoothness, since Reference Trajectory Generator was modeled as a quadratic programming problem. The optimality and feasibility of the reference trajectory will be destroyed due to the consideration of obstacles. The existing approach is to discard the original reference trajectory and recalculate the path and speed profile in the convex feasible tunnel. Obviously, recalculating the trajectory with DP + QP strategy is extremely time challenging.
Theoretically, the coordination efficiency of the high-level planner is closely related to the redundancy size, and the DP+QP method generally uses a circular collision detection model, which leads to large and inefficient redundancy, so a fast and efficient low-level planner is necessary to be proposed.
IV-A Trajectory connection and stitching
Due to the vehicle’s kinematic constraints, usually, the vehicle cannot instantaneously accelerate to a specific velocity. Therefore, we must ensure the continuity between trajectories, which means that the generated trajectory by the planner must be continuous with the current trajectory at a specific time point in order to guarantee seamless trajectory connection and switching. After the vehicle enters the buffer area of the intersection, the vehicle’s trajectory needs to switch from its own planner to a dedicated low-level planner for the intersection. The low-level planner requires a reference path, which means that we need to generate a continuous and smooth trajectory for trajectory planning. As we aim to ensure third-order continuity of the trajectory, i.e., continuity of position, velocity, acceleration, and jerk, a fifth-degree polynomial is undoubtedly a good representation. Since the general planner operates iteratively and the previous frame trajectory ensures collision-free, sampling the points on the previous frame trajectory as the starting point for the next frame trajectory is effective. Based on the desired trajectory length, we can sample the endpoint on the reference trajectory. Similar to the Reference Trajectory Generator, we can also solve a quadratic programming problem to obtain one or multiple segments of quintic polynomials as the initial values for the low-level planner. Due to space limitations, a detailed introduction is not provided here.
IV-B Problem Formulation
Inspired by [44], we propose a gradient optimization-based trajectory generation scheme. In addition to the reference trajectory, we further consider four more factors: smoothness, kinematic feasibility, energy efficiency and collision avoidance, which can effectively avoid the time consuming trajectory re-calculation. The trajectory is represented by a -th order uniform B-Spline curve, and can be optimized by the control points of the B-Spline curve by gradient of the cost function. The original control points of B-Spline curve can be calculated by reference trajectories.
In general, the maneuver smoothness can be characterized via the acceleration, jerk and snap [42], specifically, the snap can be ignored when . The kinematics feasibility cost is represented by the limitation of lateral acceleration. In terms of fuel efficiency, the optimal velocity profile is a constant [19]. Intuitively, we try to minimize the longitudinal acceleration, to approach the expected constant velocity. Thus, the smoothing, kinematics feasibility and energy efficiency terms of cost function can be expressed succinctly as following:
(24) |
where .
The B-Spline curve is convex, which indicates that a span B-Spline curve can be controlled by successive control points. Another property is that the -th order derivative of a B-Spline curve is also a B-Spline curve with . In our study, , the 3-th order derivative of a single span B-Spline curve is a constant, thus, the snap term can be ignored in the cost function [45].
For uniform B-Spline curve with control points, the number of knots is , the knots vector can be represented by with constant interval . The velocity , acceleration and jerk can be obtained by
(25) |
Thus, the cost function can be rewritten as
(26) |

IV-C Collision Avoidance
The most difficult part of the low-level planner is the cost function with obstacle avoidance. In [44], it is only applicable to objects with round or square outlines. In a more general sense, we focus on the research of the planner itself. Therefore, we assume that the state of dynamic obstacles can be perfectly predicted. Thus, sampling the position of dynamic obstacles at a single time point can be treated as a static obstacle [46]. In a typical going straightforward scenario, as shown in Fig. 7. we sample the position of B-spline trajectory on the time knot, , we check whether there are potential collisions. With the predictor we can get the position and state of the obstacles and the grid occupied by the obstacles can be obtained. Record the -th potential collision grids nearby as , then the gradient generation vector can be calculated by
(27) |
Theoretically, the closer the collision point, the greater the cost. A reasonable piecewise polynomial loss function is necessary, which is twice continuously differentiable. First, if the collision points are within a circle with the vehicle center as the center of circle and the diagonal of vehicle as the diameter, it will apply a higher penalty to the control points. Considering the error of control model and the grid size, we set an additional redundancy to keep collision-free, which apply a lower penalty. Finally, the piecewise polynomial function of collision avoidance can be represented by
(28) |
where , and are two important parameters of piecewise polynomials. is the collision cost value of caused by collision gird . The total collision cost of can be evaluated independently, i.e., , is the number of collision grid of . Then the collision cost of entire trajectory can be evaluated by all control points.
(29) |
For the gradient of collision term, it can be evaluated by the derivative of with respect of directly.
(30) | ||||
where is the weight of in time knot .
IV-D Trajectory Optimization
The trajectory optimization problem considering collision avoidance can be modeled as an unconstrained optimization problem as (31), which uses some tricks to achieve approximate hard constraints.
(31) |
We generate the control points of the B-Spline curve with the sampling points and states of the startpoint and endpoint of the reference trajectory. To ensure the continuity between the startpoint of the curve and the previous frame trajectory result, we cannot optimize the first three control points. However, due to the iteration of the planner, the last three control points can be optimized. Therefore, the number of control points must be greater than four. Since the objective function is higher than quadratic and quadratic terms dominate, the Hessian matrix can be used to accelerate the optimization process. In [44], L-BFGS solver [47] has a good performance in unconstrained optimization, thus, we optimize the control points with L-BFGS solver.
When obstacles appear in the intersection, bypassing these obstacles may cause the vehicle to deviate from the feasible tunnel. This means that other vehicles need to consider this vehicle as an unexpected obstacle. Large obstacles may block the entire intersection, but this is not within the scope of our research. After optimization, collision may still exist or the trajectory is not smooth enough, low-level planner can optimize again by increasing the weight of the corresponding term to make the trajectory meet the constraints, but in most cases, once is enough.
V Simulation Results
In this section, we performed simulations in a typical four-lane road intersection scenario as shown in Fig. 1, to demonstrate the performance of our proposed method. We compare it with the existing solutions in Section II-F. We consider only the space-time resources within the intersection Conflict Area. The reference trajectory of the vehicle is given by Section III-A and IV-A.
Parameters | Value | Parameters | Value |
---|---|---|---|
, | |||
V-A high-level planner
The simulation parameters are listed in Table. I. Fig. 8 shows the reference trajectory provided by the Reference Trajectory Generator, which avoids the flaw of line & circle curve paths and improves smoothness and feasibility. Theoretically, the Reference Trajectory Generator is scalable in multi-lane road intersections.


V-A1 Space-Time Resource Allocation
For four left-turning CAVs from different roads, theoretically, it is a reasonable solution that CAVs enter the intersection in sequence. The same strategy is given in our experiments. Fig. 9 shows the reference trajectories and resource allocations of the CAVs in this scenario, we only set in particular simulation for better illustration of space-time resource blocks.
In this result, the resource blocks of different CAVs touch on the t-axis, which indicating that the CAVs pass through the road intersection without collision. This essentially shows that single vehicle finds the optimal solution, i.e. the fastest solution to get through the road intersection, subject to the order of passage provided by the high-level planner.


V-A2 Speed Profile Analysis
In a typical four left-turn CAVs scenario, Fig. 10 represents the output of our proposed method compared with CS and STRS in ST coordinate system of Frenét Frame [41], respectively. In Fig. 10LABEL:sub@fig::OUR_CS, since the solution of CS strategy is that the road intersection can be occupied by only one vehicle at the same time, the latter vehicle must enter the intersection after the former one has left, this strategy leads to a less efficient intersection passage.
In Fig. 10LABEL:sub@fig::OUR_STRS, unlike the CS and our proposed approach, the STRS strategy adjusts the speed profile by DP+QP to find the optimal solution. Since the goal of the STRS strategy is to find the optimal solution of comfort and fuel efficiency without collision for each vehicle, which is often not optimal for pass throughput.
The key issue of our proposed strategy is to ensure that the space-time resource blocks do not overlap, to guarantee safety. While the trajectory comfort could be guaranteed by the reference trajectory. Therefore, combining the results of the three strategies above, our proposed method improves the traffic throughput compared to the CS strategy, but the comfort level is not as high as STRS.


V-A3 Waiting Time Term
We set up an extreme simulation scenario where there are three CAVs going straight on Road 1 and Road 3 respectively, and three CAVs turning left on Road 2 and Road 4 respectively. Fig. 11LABEL:sub@fig::resourceOf12_1 shows the resource allocation results without considering the waiting time term, where the resources allocation for CAVs from different roads are distinguished by different colors. Because CAVs going straight have shorter distances and can move out the intersection earlier, the high-level planner prefer to raise the priority of CAVs going straight, which would lead to unfairness. In Fig. 11LABEL:sub@fig::resourceOf12_2, with the introduction of the waiting time term to priority, the scheduler will avoid the situation that long waiting time of the first vehicle in road queue and ensure the fairness of CAVs with different maneuvers in different roads.
V-A4 Total Passing Time
Due to the different objectives of the High-Level coordination method, it mainly faces the contradiction between comfort and traffic efficiency. Therefore, the actual performance of the algorithm cannot be explained by directly comparing the total passing time of same traffic flow. We generate two kinds of traffic flows to compare the ability of different methods to tap the potential of the road intersection in the face of different traffic flows. Traffic flow 1 consists of 50% left-turning CAVs, right-turning CAVs and straight-going CAVs accounted for 25% each. Traffic flow 2 consists of 50% straight-going CAVs, 25% right-turning CAVs and 25% left-turning CAVs. Fig. 12 shows the total passing time of CS, STRS, and our proposed approach versus the number of vehicles when facing different traffic flows.
Just like the conclusion of V-A2, due to the waste of resources, CS strategy can not make the most of the resources at the crossroads and has the lowest traffic efficiency of the road intersection. Because in the face of different traffic flows, the two total passing time did not widen the gap. The STRS strategy try to find the optimal solution of comfort and fuel efficiency, which means that the total passing time of STRS strategy is not always the optimal. However, this method can greatly realize the potential of intersections in the face of traffic flow with more straight traffic. Similar to STRS, our proposed approach can also ensure the efficiency of intersections in the face of different traffic flows. which sacrifices some comfort and achieves an increase in intersection throughput. Nonetheless, a possible corollary is that modifications to the optimization objective in STRS strategy can theoretically lead to an optimal solution for the passage efficiency, since the STRS strategy searches all speed profiles at a certain resolution iteratively.


V-A5 Computation Efficiency
We conducted comparative experiments using the source code provided by [28]. In the same traffic flow scenario, Fig. 13 demonstrates a phenomenon: the computation time performance of our proposed strategy outperforms other strategies for reference only. This can be attributed to the fact that the CS strategy uses a Quadratic Programming + Linear Programming solving approach, which results in a much lower computational complexity compared to the DP+QP strategy used in STRS. However, it’s worth noting that the CS source code employs velocity sampling points as the optimization target, leading to large-scale QP problems and an unacceptable computational efficiency.
We believe that with careful optimization of the source code, the CS strategy might achieve computational efficiency similar to that of our proposed method, as CS does not need to consider a large number of spatiotemporal resource blocks but requires considering a considerable number of velocity curve sampling points, owing to the nature of the CS strategy. However, even with optimization, the STRS strategy struggles to achieve satisfactory computational efficiency due to its inherent high algorithm complexity.
Therefore, it is important to highlight that the comparative experiments regarding computational efficiency are intended for reference purposes only. They do not imply that the three algorithms exhibit such a significant disparity in computational consumption during actual deployment, as the quality of code optimization may vary significantly between different implementations.
V-A6 The relationship between redundancy and traffic efficiency
We performed experiments using the same high-level planner parameters as outlined in Table. I. Redundancy size was set from m to m with an interval of m. The experiments were conducted with 100 vehicles in a random traffic flow scenario, where vehicles were uniformly distributed, randomly entering and departing from different lanes (excluding the entering lane). We recorded the entry time of each vehicle at the intersection. Fig. 14 illustrates the entry time of the 100 vehicles at the intersection for different redundancy sizes, while Fig. 15 demonstrates the variation in scheduling efficiency for different redundancy sizes. By comparing the data shown in the figure, we observed that the overall scheduling efficiency decreases significantly as the redundancy size increases. However, different redundancy sizes can cause changes in the baseline of vehicle priority, so without adjusting the corresponding parameters, there might be a slightly higher throughput efficiency with a slightly larger redundancy. The essential reason is that we prioritize optimal scheduling priority in each round, rather than optimizing traffic efficiency. Additionally, it is not realistic to consider scheduling efficiency alone as the sole optimization objective also the reason for the change. Based on previous research experience [28, 13, 48], it is necessary to transform it into a sequence optimization problem, which also implies the utilization of receding horizon control. Nevertheless, larger redundancy provides the scheduling system with higher robustness to deal with unexpected events such as control system errors, positioning system errors, and unexpected obstacles. Therefore, we confidently conclude that the redundancy size represents the trade-off between scheduling system efficiency and robustness.


Parameters | Value | Parameters | Value |
---|---|---|---|


V-B low-level planner
V-B1 Trajectory Analysis
Fig. 16 shows a simulation results comparison between our proposed and the DP+QP [25, 28] strategy. The gray area represents an obstacle projected into the Frenét Frame, the solid line represents the result of DP+QP strategy, and the dashed line represents the simulation result of our proposed method. The simulation parameters are listed in Table. 2. We observed that both trajectories were effective in obstacle avoidance. However, the obstacle avoidance strategy of DP+QP, which is based on a circular bounding box model, requires a larger space, leading to increased safety redundancy and decreased efficiency in high-level planner. Additionally, when examining the curvature profile in Fig. 17, the trajectories generated by the low-level planner of DP+QP lack smoothness. The curvature curve exhibits significant fluctuations, and high curvatures often approach the vehicle’s kinematic limitation, resulting in lower comfort. On the other hand, our proposed algorithm generates trajectories with smaller and smoother curvature profiles, improving controllability and predictability in direction changes. This smoothness enhances the comfort of the vehicle, reduces wheel vibrations, and ensures adherence to the constraints of the vehicle’s kinematic model [49].
V-B2 Dynamic obstacle avoidance
Essentially, our planner can extend obstacle avoidance from static obstacles to dynamic case. To demonstrate this, an additional experiment is finished to prove the ability of our proposed planner to evade dynamic obstacles, as shown in Fig. 18. In the experiment, the predicted trajectories of obstacles were predefined, and we sampled the predicted trajectories of the obstacles at each time knot. For clarity, we only show the relevant nodes affecting the trajectory. From the figure, we can observe that our planner can effectively dodge dynamic obstacles, just as it would with static obstacles.

V-B3 Computation Time
Computational time consumption is also an important consideration for the local planner, as faster computation means vehicles have more time to respond to unexpected events. Therefore, we compared the computation time between the DP+QP strategy and our proposed method to illustrate this. Typically, in practical autonomous vehicles, the DP+QP strategy can be accelerated using multithreading. Although our proposed low-level planner could also benefit from multithreading, we deliberately used single-thread computation for consistency. In the context of intersection scenarios, excessive deceleration of vehicles leads to intersection blockage. As a result, we compared our proposed method to the path planners in [28] and [32]. In a typical obstacle avoidance scenario, as shown in Fig. 16, our method only requires to complete one frame of planning, including trajectory safety checks. We conducted experiments using default parameters provided in the referenced papers. Due to the exponential complexity, the path planners took several hundred milliseconds to compute, with a result of in our experiments. Therefore, our proposed method demonstrates excellent operational efficiency.
VI Laboratory Experiments
Finally, in order to verify the feasibility and robustness of our proposed double-level coordination strategy, we used four autonomous mobile robots with robot operating systems (ROS) [50] to complete the laboratory experiments. We used the desktop computer to run the high-level planner, distributed the results of the high-level planner to the mobile robot through ROS network communication, and the low-level planner was completed with the mobile robot onboard computers. In order to conform to the reality, we mainly adjusted the experimental parameters: , , , .
Fig. 19 shows the mobile robot we used, which is equipped with Intel T265 tracking camera and D455 depth camera. In this experiment, we only used T265 for online localization, and perceptual results were generated offline. In addition, we use the Intel NUC microcomputer as the onboard computer, and the sufficient computing resources enable the platform to ensure real-time performance.

VI-A high-level planner experiment I

Fig. 20 shows a typical laboratory road intersection scenario. In this experiment, four mobile robots all adopt a left turn strategy. We use large safety redundancy and fast reference speed, i.e., , . In this experiment, due to the large safety redundancy, CAVs in the diagonal roads cannot enter the intersection simultaneously, thus, the CAVs need to enter the intersection one by one. We plotted the reference path of CAV1 with red curve to show the error of the control system. With proper security redundancy, our proposed can realize the throughput potential of the intersection without collision.
VI-B high-level planner experiment II
In Fig. 21, We reduce security redundancy, i.e., . We plotted the reference paths of CAV1 and CAV3 with red curves, their reference trajectories don’t conflict, thus, the CAVs from the diagonal roads can enter the road intersection simultaneously.

VI-C Double-level coordination strategy experiment
With unexpected obstacles in the intersection or a large control error, coordination strategy requires the intervention of the low-level planner. In this laboratory experiment, we adopt relatively lower reference speed () and same redundancy with high-level planner experiment I. A static obstacle is arranged in the intersection, which is marked by red box. As a result of this obstacle, the reference trajectory of the CAV2 is exposed to potential collision. After spotting the obstacle, CAV2 generates the collision free trajectory base on the result of high-level planner by low-level planner. Fig. 22 shows the results of the experiment.

VII Conclusion
In this paper, We try to give a tightly coupled two level coordination framework for CAVs at non-signalized road intersections. Aiming at the computational complexity at the high-level planner, we decouple the original problem into sequential optimization ones, to generate the available space and time resource blocks, namely feasible tunnels, for each vehicle. Furthermore, a low-level planner is also given under the constraints from FTs, to avoid potential collisions with unexpected non-CAV obstacles. We provide numerical results via simulations and laboratory experiments, which could achieve coordination within millisecond level. Although the uncertainties during coordination could be accommodated by the redundancy design of FTs, it is still prone to severe errors from sensing, control and communications. The robustness issue of this two-level coordinator will be discussed in our future work.
References
- [1] M. Alsabaan, W. Alasmary, A. Albasir, and K. Naik, “Vehicular networks for a greener environment: A survey,” IEEE Communications Surveys & Tutorials, vol. 15, no. 3, pp. 1372–1388, 2013.
- [2] S. Dornbush and A. Joshi, “Streetsmart traffic: Discovering and disseminating automobile congestion using vanet’s,” in 2007 IEEE 65th Vehicular Technology Conference - VTC2007-Spring, 2007, pp. 11–15.
- [3] P. G. Shinde and M. M. Dongre, “Traffic congestion detection with complex event processing in vanet,” in 2017 Fourteenth International Conference on Wireless and Optical Communications Networks (WOCN), 2017, pp. 1–5.
- [4] Y. Zhao, S. Yao, D. Liu, H. Shao, and S. Liu, “Greenroute: A generalizable fuel-saving vehicular navigation service,” in 2019 IEEE International Conference on Autonomic Computing (ICAC), 2019, pp. 1–10.
- [5] H. Wu and S. Malipeddi, “Influential factors for severe traffic crashes,” in Proceedings of 2011 IEEE International Conference on Vehicular Electronics and Safety, 2011, pp. 71–75.
- [6] E.-H. Choi, “Crash factors in intersection-related crashes: An on-scene perspective,” 2010.
- [7] E. A. Bellis and J. Page, “National motor vehicle crash causation survey (nmvccs) sas analytical users manual,” 2008.
- [8] L. Chen and C. Englund, “Cooperative intersection management: A survey,” IEEE Transactions on Intelligent Transportation Systems, vol. 17, no. 2, pp. 570–586, 2016.
- [9] D. B. Rawat, B. B. Bista, G. Yan, and S. Olariu, “Vehicle-to-vehicle connectivity and communication framework for vehicular ad-hoc networks,” in 2014 Eighth International Conference on Complex, Intelligent and Software Intensive Systems, 2014, pp. 44–49.
- [10] Y. A. Vershinin and Y. Zhan, “Vehicle to vehicle communication: Dedicated short range communication and safety awareness,” in 2020 Systems of Signals Generating and Processing in the Field of on Board Communications, 2020, pp. 1–6.
- [11] P. Lin, J. Liu, P. J. Jin, and B. Ran, “Autonomous vehicle-intersection coordination method in a connected vehicle environment,” IEEE Intelligent Transportation Systems Magazine, vol. 9, no. 4, pp. 37–47, 2017.
- [12] Z. Li, Q. Wu, H. Yu, C. Chen, G. Zhang, z. tian, and P. D. Prevedouros, “Temporal-spatial dimension extension-based intersection control formulation for connected and autonomous vehicle systems,” Transportation Research Part C Emerging Technologies, vol. 104, pp. 234–248, 07 2019.
- [13] Z. Yao, H. Jiang, Y. Jiang, and B. Ran, “A two-stage optimization method for schedule and trajectory of cavs at an isolated autonomous intersection,” IEEE Transactions on Intelligent Transportation Systems, vol. 24, no. 3, pp. 3263–3281, 2023.
- [14] D. González, J. Pérez, V. Milanés, and F. Nashashibi, “A review of motion planning techniques for automated vehicles,” IEEE Transactions on Intelligent Transportation Systems, vol. 17, no. 4, pp. 1135–1145, 2016.
- [15] F. Perronnet, J. Buisson, A. Lombard, A. Abbas-Turki, M. Ahmane, and A. El Moudni, “Deadlock prevention of self-driving vehicles in a network of intersections,” IEEE Transactions on Intelligent Transportation Systems, vol. 20, no. 11, pp. 4219–4233, 2019.
- [16] J. Lee and B. Park, “Development and evaluation of a cooperative vehicle intersection control algorithm under the connected vehicles environment,” IEEE Transactions on Intelligent Transportation Systems, vol. 13, no. 1, pp. 81–90, 2012.
- [17] M. A. S. Kamal, J.-i. Imura, T. Hayakawa, A. Ohata, and K. Aihara, “A vehicle-intersection coordination scheme for smooth flows of traffic without using traffic lights,” IEEE Transactions on Intelligent Transportation Systems, vol. 16, no. 3, pp. 1136–1147, 2015.
- [18] S. Li, K. Shu, Y. Zhou, D. Cao, and B. Ran, “Cooperative critical turning point-based decision-making and planning for cavh intersection management system,” IEEE Transactions on Intelligent Transportation Systems, vol. 23, no. 8, pp. 11 062–11 072, 2022.
- [19] R. Hult, G. R. Campos, E. Steinmetz, L. Hammarstrand, P. Falcone, and H. Wymeersch, “Coordination of cooperative autonomous vehicles: Toward safer and more efficient road transportation,” IEEE Signal Processing Magazine, vol. 33, no. 6, pp. 74–84, Nov 2016.
- [20] G. Rodrigues de Campos, P. Falcone, R. Hult, H. Wymeersch, and J. Sjöberg, “Traffic coordination at road intersections: Autonomous decision-making algorithms using model-based heuristics,” IEEE Intelligent Transportation Systems Magazine, vol. 9, no. 1, pp. 8–21, 2017.
- [21] M. Wang, T. Zhang, L. Gao, and Q. Zhang, “High throughput dynamic vehicle coordination for intersection ground traffic,” in 2018 IEEE 88th Vehicular Technology Conference (VTC-Fall), 2018, pp. 1–6.
- [22] Y. Mo, M. Wang, T. Zhang, and Q. Zhang, “Autonomous cooperative vehicle coordination at road intersections,” in 2018 IEEE International Conference on Communication Systems (ICCS), 2018, pp. 192–197.
- [23] C. Liu, Y. Mo, B. Gao, and T. Zhang, “Low complexity coordination strategies at multi-lane intersections,” in 2019 IEEE Globecom Workshops (GC Wkshps), 2019, pp. 1–6.
- [24] C. Liu, Y. Zhang, T. Zhang, X. Wu, L. Gao, and Q. Zhang, “High throughput vehicle coordination strategies at road intersections,” IEEE Transactions on Vehicular Technology, vol. 69, no. 12, pp. 14 341–14 354, 2020.
- [25] Y. Zhang, G. Chen, and T. Zhang, “Intelligent intersection coordination and trajectory optimization for autonomous vehicles,” in 2021 IEEE International Conference on Autonomous Systems (ICAS), 2021, pp. 1–6.
- [26] X. Pan, B. Chen, S. Timotheou, and S. A. Evangelou, “A convex optimal control framework for autonomous vehicle intersection crossing,” IEEE Transactions on Intelligent Transportation Systems, vol. 24, no. 1, pp. 163–177, 2023.
- [27] J. Luo, T. Zhang, R. Hao, D. Li, C. Chen, Z. Na, and Q. Zhang, “Real-time cooperative vehicle coordination at unsignalized road itersections,” arXiv e-prints, p. arXiv:2205.01278, May 2022.
- [28] Y. Zhang, R. Hao, T. Zhang, X. Chang, Z. Xie, and Q. Zhang, “A trajectory optimization-based intersection coordination framework for cooperative autonomous vehicles,” IEEE Transactions on Intelligent Transportation Systems, vol. 23, no. 9, pp. 14 674–14 688, 2022.
- [29] C. Chen, Q. Xu, M. Cai, J. Wang, B. Xu, X. Wu, J. Wang, K. Li, and C. Qi, “A graph-based conflict-free cooperation method for intelligent electric vehicles at unsignalized intersections,” in 2021 IEEE International Intelligent Transportation Systems Conference (ITSC), 2021, pp. 52–57.
- [30] X. Cong, B. Yang, F. Gao, C. Chen, and Y. Tang, “Virtual platoon based cavs cooperative driving at unsignalized intersection,” in 2022 IEEE 25th International Conference on Intelligent Transportation Systems (ITSC), 2022, pp. 53–58.
- [31] A. A. Malikopoulos, L. Beaver, and I. V. Chremos, “Optimal time trajectory and coordination for connected and automated vehicles,” Automatica, vol. 125, p. 109469, mar 2021. [Online]. Available: https://doi.org/10.1016%2Fj.automatica.2020.109469
- [32] H. Fan, F. Zhu, C. Liu, L. Zhang, L. Zhuang, D. Li, W. Zhu, J. Hu, H. Li, and Q. Kong, “Baidu apollo EM motion planner,” CoRR, vol. abs/1807.08048, 2018. [Online]. Available: http://arxiv.org/abs/1807.08048
- [33] M. A. S. Kamal, T. Hayakawa, and J.-i. Imura, “Development and evaluation of an adaptive traffic signal control scheme under a mixed-automated traffic scenario,” IEEE Transactions on Intelligent Transportation Systems, vol. 21, no. 2, pp. 590–602, 2020.
- [34] X. Huang, P. Lin, M. Pei, B. Ran, and M. Tan, “Reservation-based cooperative ecodriving model for mixed autonomous and manual vehicles at intersections,” IEEE Transactions on Intelligent Transportation Systems, vol. 24, no. 9, pp. 9501–9517, 2023.
- [35] Z. Yao, H. Jiang, Y. Cheng, Y. Jiang, and B. Ran, “Integrated schedule and trajectory optimization for connected automated vehicles in a conflict zone,” IEEE Transactions on Intelligent Transportation Systems, vol. 23, no. 3, pp. 1841–1851, 2022.
- [36] H. Jiang, Z. Yao, Y. Jiang, and Z. He, “Is all-direction turn lane a good choice for autonomous intersections? a study of method development and comparisons,” IEEE Transactions on Vehicular Technology, vol. 72, no. 7, pp. 8510–8525, 2023.
- [37] J. Kong, M. Pfeiffer, G. Schildbach, and F. Borrelli, “Kinematic and dynamic vehicle models for autonomous driving control design,” in 2015 IEEE Intelligent Vehicles Symposium (IV), 2015, pp. 1094–1099.
- [38] T. Liang, T. Zhang, J. Yang, D. Feng, and Q. Zhang, “UAV-Aided positioning systems for ground devices: Fundamental limits and algorithms,” IEEE Internet of Things Journal, vol. 9, no. 15, pp. 13 470–13 485, 2022.
- [39] H. Li, M. Tsukada, F. Nashashibi, and M. Parent, “Multivehicle cooperative local mapping: A methodology based on occupancy grid map merging,” IEEE Transactions on Intelligent Transportation Systems, vol. 15, no. 5, pp. 2089–2100, 2014.
- [40] J. Horst and A. Barbera, “Trajectory generation for an on-road autonomous vehicle,” Proc Spie, vol. 6230, p. 82, 2006.
- [41] M. Werling, J. Ziegler, S. Kammel, and S. Thrun, “Optimal trajectory generation for dynamic street scenarios in a frenét frame,” 2010 IEEE International Conference on Robotics and Automation, pp. 987–993, 2010.
- [42] D. Mellinger and V. Kumar, “Minimum snap trajectory generation and control for quadrotors,” in 2011 IEEE International Conference on Robotics and Automation, 2011, pp. 2520–2525.
- [43] Neely and J. Michael, “Stochastic network optimization with application to communication and queueing systems,” Synthesis Lectures on Communication Networks, vol. 3, no. 1, p. 211, 2010.
- [44] X. Zhou, Z. Wang, H. Ye, C. Xu, and F. Gao, “Ego-planner: An esdf-free gradient-based local planner for quadrotors,” IEEE Robotics and Automation Letters, vol. 6, no. 2, pp. 478–485, 2021.
- [45] V. Usenko, L. von Stumberg, A. Pangercic, and D. Cremers, “Real-time trajectory replanning for mavs using uniform b-splines and a 3d circular buffer,” in 2017 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), 2017, pp. 215–222.
- [46] H. Zhao, J. Gao, T. Lan, C. Sun, B. Sapp, B. Varadarajan, Y. Shen, Y. Shen, Y. Chai, C. Schmid, C. Li, and D. Anguelov, “TNT: Target-driveN trajectory prediction,” arXiv e-prints, p. arXiv:2008.08294, Aug. 2020.
- [47] P. T. Boggs and R. H. Byrd, “Adaptive, limited-memory BFGS algorithms for unconstrained optimization,” SIAM Journal on Optimization, vol. 29, no. 2, pp. 1282–1299, 2019. [Online]. Available: https://doi.org/10.1137/16M1065100
- [48] W. Wu, Y. Liu, W. Liu, F. Zhang, V. Dixit, and S. T. Waller, “Autonomous intersection management for connected and automated vehicles: A lane-based method,” IEEE Transactions on Intelligent Transportation Systems, vol. 23, no. 9, pp. 15 091–15 106, 2022.
- [49] J. Wang, Y. Yan, K. Zhang, Y. Chen, M. Cao, and G. Yin, “Path planning on large curvature roads using driver-vehicle-road system based on the kinematic vehicle model,” IEEE Transactions on Vehicular Technology, vol. 71, no. 1, pp. 311–325, 2022.
- [50] M. Quigley, B. P. Gerkey, K. Conley, J. Faust, and A. Y. Ng, “Ros: An open-source robot operating system,” 2009.