Next Article in Journal
Correction: Saeed et al. Anomaly Detection in 6G Networks Using Machine Learning Methods. Electronics 2023, 12, 3300
Previous Article in Journal
Long-Range Sensing with CP-OFDM Waveform: Sensing Algorithm and Sequence Design
Previous Article in Special Issue
Development of a Pipeline-Cleaning Robot for Heat-Exchanger Tubes
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Convex Optimization-Based Constrained Trajectory Planning for Autonomous Vehicles

School of Intelligent Systems Engineering, Shenzhen Campus of Sun Yat-sen University, Shenzhen 518107, China
*
Author to whom correspondence should be addressed.
These authors contributed equally to this work.
Electronics 2025, 14(15), 2929; https://doi.org/10.3390/electronics14152929
Submission received: 20 June 2025 / Revised: 15 July 2025 / Accepted: 16 July 2025 / Published: 22 July 2025

Abstract

This paper proposes a constrained trajectory optimization framework for autonomous vehicles (AVs) based on convex programming techniques. An enhanced kinematic vehicle model is introduced to capture dynamic motion characteristics that are often overlooked in conventional models. For obstacle avoidance, environmental constraints are transformed into convex formulations using free-space corridor methods. The trajectory planning process is further optimized through a linearized model predictive control (MPC) scheme, which considers both vehicle dynamics and environmental safety. The resulting formulation enables efficient convex optimization suitable for real-time implementation. Experimental results in various scenarios demonstrate improvements in both trajectory smoothness and safety. Furthermore, the proposed optimization method reduces the average execution time by nearly 70% compared to the nonlinear alternative, validating its computational efficiency and practical applicability.

1. Introduction

Autonomous driving technology has made remarkable strides in both academia and industry, expanding its applications from highway scenarios to increasingly complex urban environments [1], as illustrated in Figure 1. Compared to highway scenarios, urban driving involves denser and more dynamic environments, including pedestrians, cyclists, and vehicles. These agents often behave unpredictably, significantly complicating trajectory planning tasks [2]. Increasing attention is being paid to modeling interactions with dynamic agents through intention-aware predictors, game-theoretic formulations, or learned behavior models. Additionally, the irregular shape of the ego vehicle creates nonlinear constraints for the collision avoidance task, which further complicates the planning problem. Thus, effective urban trajectory planning is critical for ensuring safety, ride comfort, and overall efficiency. Specifically, the planner must simultaneously manage complex vehicle dynamics and real-time obstacle avoidance with limited computational resources. To this end, modern approaches are exploring strategies such as sequential convex programming (SCP), hybrid convex–non-convex formulations, and adaptive receding horizon planning to improve flexibility under non-convex constraints.
The primary aim of this paper is to address these challenges by introducing a novel convex optimization framework for trajectory planning, specifically tailored to urban driving environments. We propose an enhanced vehicle kinematic model that integrates acceleration and steering dynamics, providing a more realistic representation of vehicle motion. Additionally, we present a robust method to construct convex feasible areas through spatial corridor techniques, effectively simplifying the obstacle avoidance problem into manageable convex constraints. Our method formulates the trajectory planning problem as a constrained quadratic programming (QP) task within a linearized model predictive control (MPC) framework, enabling efficient and reliable solutions even in dynamic environments. By using a discretized enhanced kinematic bicycle model, the system achieves accurate state prediction while remaining computationally efficient. The spatial corridors tightly constrain the vehicle within a safe navigable space, while soft constraints further enhance passenger comfort by allowing flexibility to maintain distances from obstacles. The main contributions of this work include the following:
  • A comprehensive derivation and analysis of an enhanced kinematic bicycle model that includes acceleration and steering dynamics;
  • A robust and practical obstacle avoidance strategy designed for complex urban environments, ensuring robust safety and feasibility;
  • Implementation and validation of a real-time convex optimization framework within a linearized MPC structure, supported by extensive simulation experiments.

2. Related Work

The trajectory planning methods are typically classified into three categories: search-based, sampling-based, and optimization-based planning, as illustrated in Figure 2. Search-based algorithms [3,4,5] discretize the environment and perform graph-based searches to identify feasible paths. Nevertheless, due to their coarse resolution and computational cost, these methods are typically applied in unstructured or low-speed scenarios, such as parking [6]. The sampling-based approaches [7,8], on the other hand, sample multiple candidate trajectories by selecting a range of target points and generating corresponding paths. The corresponding paths are generated using predefined curve models, such as polynomial curves or Bézier curves. Each trajectory is evaluated using a cost function, and the one with the highest score is selected as the output. However, the performance of these sampling-based methods depends heavily on sampling density and curve models, and is limited by the state space coverage. They also face challenges in handling dynamic obstacles and real-time constraints. In contrast, the optimization-based trajectory planning [9,10] is a more advanced approach. This approach directly formulates the trajectory generation problem as a numerical optimization problem, where the vehicle’s future states serve as optimization variables. These methods are well-suited for complex urban environments as they can incorporate detailed safety non-convex constraints such as obstacle avoidance [11]. Additionally, they produce flexible and smooth trajectories while maintaining computational efficiency.
Obstacle avoidance strategies generally fall into two categories: potential field-based and spatial corridor-based methods. Potential field methods treat the vehicle as if it is moving within a virtual force field [12,13]. These methods are computationally efficient but often struggle with sensitivity to parameter tuning and may perform poorly in cluttered environments. While this approach is intuitive and lightweight, it is less suitable for handling road boundaries. This is because potential fields model obstacles as repulsive points or regions, which works well for discrete obstacles but is less effective for continuous features like road boundaries. Unlike obstacles, road boundaries do not simply act as barriers to avoid; they define a navigable corridor. When these continuous lane boundaries are modeled as repulsive forces, it can lead to unnatural or oscillatory behavior, particularly near the edges of the road. In contrast, spatial corridor methods define safe navigation zones, which enable dynamically feasible trajectories. These trajectories are better aligned with the vehicle’s kinematic constraints [14,15]. These methods leverage environmental information to construct the corridors, ensuring a safer and more efficient navigation process. However, it is equally important to implement an effective scheme for constructing these corridors, ensuring the safety and adaptability to changing road conditions. Some previous studies generated corridors using a predefined expansion order and constant size, which were inadequate and often struggled with curved roads featuring large curvatures [16].
The trajectory planning problem can be approached in either the Cartesian coordinate system through spatio-temporal planning [17] or in the Frenet frame using path-speed decoupling [18,19]. The Cartesian approach provides high accuracy for both vehicle kinematics and environment modeling, while the Frenet frame leverages road reference lines to simplify path representation [20]. Table 1 summarizes the differences between Cartesian and Frenet coordinate systems. Both methods typically start with an initial coarse solution, followed by optimization for smoothness [21]. A good initial guess can significantly accelerate convergence in numerical optimization.
Recent research has focused on reformulating trajectory planning problems as convex optimization problems. Prior studies have shown that such problems can be cast as quadratic programming (QP) problems [22,23], incorporating obstacle avoidance as linear constraints. However, the following key challenges remain: (1) efficiently and accurately generating collision-free trajectories in environments with dense and unknown obstacles; (2) optimizing the computational efficiency and robustness within the constraints of limited computing resources; (3) improving the feasibility and flexibility of trajectory generation without sacrificing safety or integrity.
The rest of the paper is organized as follows: Section 3 introduces the proposed kinematic model. Section 4 details the trajectory planning method. Section 5 presents the experimental results. Finally, Section 6 summarizes the paper and draws conclusions.

3. Proposed Vehicle Kinematics

In this section, we adopt an extended bicycle model to describe vehicle motion, incorporating acceleration and steering for higher fidelity. The vehicle’s state is denoted by position ( x , y ), heading angle θ , and velocity v, while control inputs include acceleration a and front wheel angle δ . The simplified model can be expressed as follows:
x ˙ = v c o s θ y ˙ = v s i n θ θ ˙ = v t a n δ L v ˙ = a ,
where L represents the wheelbase of the vehicle, as shown in Figure 3.
One could use a differentially flat vehicle model [24] considering the flat output [25], represented as follows:
v = x ˙ 2 + y ˙ 2 = ˙ T ˙ 1 / 2 θ = arctan 2 y ˙ , x ˙ a = x ˙ x ¨ + y ˙ y ¨ / x ˙ 2 + y ˙ 2 = ¨ T ˙ ˙ T ˙ 1 / 2 δ = arctan x ˙ y ¨ y ˙ x ¨ L / x ˙ 2 + y ˙ 2 3 / 2 = arctan ¨ T B ˙ · L ˙ T ˙ 3 / 2 ,
where : = ( x , y ) is the flat output; that is, vehicle position. B : = [ 0 , 1 ; 1 , 0 ] is an auxiliary antisymmetric matrix. When the velocity is small, variables such as acceleration and front wheel angle are undefined and therefore uncontrollable, that is, a singularity configuration issue. However, more often than in the real world, we come across the situation where the vehicle is at a very low speed.
In the model of Equation (1), there is a delay between the control input and the vehicle state; that is, not all states are directly controlled by the control input. To model motion more accurately, the vehicle is assumed to follow an arc during a discrete time interval. The center of the rotation ( C x , C y ) and rotation radius R are derived accordingly.
C x = x R s i n θ C y = y + R c o s θ R = L t a n δ .
Using the displacement Δ s , the corresponding rotation angle Δ θ is calculated:
Δ s = v Δ t + a Δ t 2 2 ,
Δ θ = Δ s R = v Δ t + a Δ t 2 2 tan δ L .
So, the vehicle’s future position ( x , y ) is predicted:
x = C x + R s i n ( θ + Δ θ ) y = C y R c o s ( θ + Δ θ ) .
Substituting Equation (3) and Equation (5) into the position update equations in Equation (6) yields the following form of new state ( x , y , θ , v ) :
x = x R s i n θ + R s i n ( θ + Δ θ ) = x L s i n θ t a n δ + L s i n ( θ + v Δ t + 0.5 a Δ t 2 L t a n δ ) t a n δ y = y + R c o s θ R c o s ( θ + Δ θ ) = y + L c o s θ t a n δ L c o s ( θ + v Δ t + 0.5 a Δ t 2 L t a n δ ) t a n δ θ = θ + ( v Δ t + a Δ t 2 2 ) t a n δ L v = v + a Δ t .
Equation (7) represents a discretized update model for the vehicle’s state. We approximate the differential form of the state change ( x ˙ , y ˙ , θ ˙ , v ˙ ) with respect to time by taking the first-order difference over the sampling interval Δ t :
x ˙ = ( v + a Δ t ) c o s ( θ + v Δ t + 0.5 a Δ t 2 L t a n δ ) y ˙ = ( v + a Δ t ) s i n ( θ + v Δ t + 0.5 a Δ t 2 L t a n δ ) θ ˙ = ( v + a Δ t ) t a n δ L v ˙ = a .
This model takes into account the impact of the vehicle’s control input on its velocity, position, and direction. These formulas can be effectively used to describe the dynamic behavior of the vehicle over a given period of time. The new model provides higher accuracy by incorporating the effects of acceleration and steering, suitable for applications requiring high dynamic accuracy. A more compact form of the kinematic model is the following:
x ˙ = f ( x , u ) ,
where x = ( x , y , θ , v ) describes the configuration of the center of the rear wheels, and u = ( a , δ ) is the control input. For a given reference trajectory, each point ( x r e f , u r e f ) also satisfies the kinematic equations. Therefore, its trajectory is expressed by the following formula:
x ˙ r e f = f ( x r e f , u r e f ) .
The reference points are generated from a coarse trajectory produced by the hybrid A* algorithm. This trajectory is sampled and smoothed to yield the nominal motion plan, which serves as the baseline for linearization in the MPC optimization. Expanding the right side of Equation (9) around the reference point using Taylor series and discarding the higher-order terms yields the following:
x ˙ = f ( x r e f , u r e f ) + f x ( x x r e f ) + f u ( u u r e f ) ,
where f x and f u are the Jacobian matrices of f with respect to x and u, respectively, evaluated around the reference point ( x r e f , u r e f ) . Then, subtracting Equation (10) from Equation (11) yields the following:
x ˙ x ˙ r e f = f x ( x x r e f ) + f u ( u u r e f ) .
Suppose x ˜ = x x r e f and u ˜ = u u r e f , which represent the error with respect to the reference point and its associated perturbation control input, respectively. Then, we obtain the following:
x ˜ ˙ = f x x ˜ + f u u ˜ = A x ˜ + B u ˜ .
To discretize the continuous-time function in Equation (13), we employ a first-order forward difference approximation. Specifically, the time derivative of x ˜ ˙ is approximated as follows:
x ˜ ˙ x ˜ ( k + 1 ) x ˜ ( k ) Δ t .
Substituting Equation (14) into the linearized dynamics Equation (13), we obtain the discrete-time system:
x ˜ ( k + 1 ) = x ˜ ( k ) + Δ t · [ A ( k ) x ˜ ( k ) + B ( k ) u ˜ ( k ) ] ,
where A ( k ) and B ( k ) are the linearized coefficients representing the linearized system dynamics around the reference trajectory at timestep k. The linearized coefficient matrices A ( k ) and B ( k ) are obtained by computing the Jacobians of the discrete-time update equations from Equation (8), with respect to the state variables x , y , θ , v and the control inputs a , δ .
A ( k ) = 0 0 ( v k + a k Δ t ) s i n ( θ k + v k Δ t + 0.5 a k Δ t 2 L t a n δ k ) c o s ( θ k + v k Δ t + 0.5 a k Δ t 2 L t a n δ k ) ( v k + a k Δ t ) s i n ( θ k + v k Δ t + 0.5 a k Δ t 2 L t a n δ k ) Δ t t a n δ k L 0 0 ( v k + a k Δ t ) c o s ( θ k + v k Δ t + 0.5 a k Δ t 2 L t a n δ k ) s i n ( θ k + v k Δ t + 0.5 a k Δ t 2 L t a n δ k ) + ( v k + a k Δ t ) c o s ( θ k + v k Δ t + 0.5 a k Δ t 2 L t a n δ k ) Δ t t a n δ k L 0 0 0 t a n δ k L 0 0 0 0 ,
B ( k ) = Δ t c o s ( θ k + v k Δ t + 0.5 a k Δ t 2 L t a n δ k ) ( v k + a k Δ t ) s i n ( θ k + v k Δ t + 0.5 a k Δ t 2 L t a n δ k ) Δ t 2 t a n δ 2 L ( v k + a k Δ t ) s i n ( θ k + v k Δ t + 0.5 a k Δ t 2 L t a n δ k ) v k Δ t + 0.5 a k Δ t 2 L s e c 2 δ k Δ t s i n ( θ k + v k Δ t + 0.5 a k Δ t 2 L t a n δ k ) + ( v k + a k Δ t ) c o s ( θ k + v k Δ t + 0.5 a k Δ t 2 L t a n δ k ) Δ t 2 t a n δ 2 L ( v k + a k Δ t ) c o s ( θ k + v k Δ t + 0.5 a k Δ t 2 L t a n δ k ) v k Δ t + 0.5 a k Δ t 2 L s e c 2 δ k Δ t t a n δ k L ( v k + a k Δ t ) s e c 2 δ k L 1 0 .
Alternatively, for simplicity and computational convenience, we absorb the sampling interval Δ t into the matrices to yield the following:
x ˜ ( k + 1 ) = A d ( k ) x ˜ ( k ) + B d ( k ) u ˜ ( k ) ,
where A d ( k ) and B d ( k ) are the discretized system matrices. This formulation enables direct integration into the discrete-time MPC prediction model used for optimization. Equation (18) represents the discrete-time update of the vehicle state at timestep k + 1 , given the current state at timestep k. A d ( k ) and B d ( k ) are used in the prediction model within the MPC optimization horizon. At this point, we have completely established the linearized and discretized kinematic model.

4. Proposed Optimization Method

This section outlines the proposed convex optimization-based trajectory planning framework. The general formulation is expressed as follows:
m i n 1 2 x T Q x + c T x ,
s . t . A e q x = b e q ,
A i e q x b i e q ,
where x R n denotes the vector of optimization variables, Q is the Hessian matrix containing second-order derivatives, and c is the gradient vector. Equality and inequality constraints are defined by matrices A e q , A i e q and vectors b e q , b i e q , respectively. The framework comprises two key modules:
  • A MPC module that incorporates the new kinematic model;
  • A feasible area generation module to ensure environmental safety.
These modules jointly determine whether the convexity condition holds. If satisfied, the framework solves a quadratic program to generate a smooth and optimized trajectory. A schematic overview is shown in Figure 4.

4.1. MPC Algorithm

The MPC module predicts future system behavior over a finite horizon N, solving an optimization problem at each time step. Only the first control input is applied, and the process repeats with updated system states.
For the sake of simplicity, we assume that the states are always measurable and there is no model mismatch. The objective functions to be optimized can be stated as a quadratic function of the states and control inputs:
  • The tracking error penalizes deviation from the reference trajectory:
    f 1 = w 1 ( x x r e f ) 2 .
  • Control deviation penalizes differences between actual and reference control inputs:
    f 2 = w 2 ( u u r e f ) 2 .
  • Control smoothness penalizes rapid changes in control inputs:
    f 3 = w 3 u ˙ 2 .
  • The final state error encourages convergence to a desired final state x r e f ( N ) :
    f 4 = w 4 ( x ( N ) x r e f ( N ) ) 2 .
  • Obstacle avoidance enforces spatial constraints using a slack variable:
    f 5 = w 5 s i 2 ,
    where s i is the relaxation factor introduced to maintain feasibility. Its role is elaborated in the following subsection.
The total cost is expressed as follows:
J = i = 1 5 w i f i .
To ensure the kinematic feasibility of the vehicle, the following inequality constraints must be satisfied:
  • Linear velocity: v m i n v v m a x .
  • Acceleration: a m i n a a m a x .
  • Jerk: a ˙ m i n a ˙ a ˙ m a x .
  • Curvature: k m i n k k m a x , k = t a n ( δ ) L .

4.2. Feasible Area Generation

To ensure the vehicle remains within a safe, obstacle-free region during planning, we construct a convex spatio-temporal corridor along a given reference trajectory. The position of dynamic obstacles is incorporated as a time-indexed sequence over the planning horizon, allowing the optimizer to account for predicted future motion patterns at each timestep. The method is structured into two main phases: hyperplane generation and polygon shrinkage.

4.2.1. Hyperplane Generation

We first approximate the vehicle’s rigid body using an ellipse. An ellipse is defined by the following:
ξ ( E , d ) = { p = E p ¯ + d , | p ¯ | 1 } ,
where E = R T S R , with R being the rotation matrix determined by the vehicle’s heading angle, and S a diagonal matrix with the ellipse’s semi-axes lengths. The vector d denotes the center of the ellipse. To fully enclose the vehicle, we compute the radius of a circle that covers its rigid body:
R = ( L r + L + L f ) 2 + L w 2 2 ,
where L r , L f , L w are the lengths of the rear axle, front axle, and vehicle width, respectively. The ellipse is scaled until it precisely wraps the vehicle. To maintain spatial continuity along the trajectory, we also consider the piecewise path segments when generating the ellipse. This guarantees that each segment of the trajectory remains constrained within a continuous, smooth corridor. We then expand the ellipse while preserving its aspect ratio until it touches an obstacle. At the contact point, a tangent hyperplane is computed:
H i = { | a i T < b i } ,
where a i R 2 and b i R define the hyperplane, and = { x , y } is the vehicle position. Obstacles lying outside the hyperplane are disregarded. Repeating this process yields a series of half-spaces whose intersection forms a convex polygon:
S = i = 0 n H i = { | A T < b } .
Here, the i-th column of matrix A and element of vector b correspond to the coefficients of the i-th hyperplane. To reduce computational complexity and maintain proximity to the initial trajectory, a bounding box is introduced. This local region R l o c a l extends 10 meters laterally from the trajectory, while its longitudinal bounds are dynamically adjusted based on the vehicle’s speed. Then, the feasible area becomes S = R l o c a l S .

4.2.2. Polygon Shrinkage

To ensure the entire vehicle is fully contained within the convex polygon, it is necessary and sufficient that all vertices of the vehicle remain inside the polygon’s boundaries. To simplify computation, we convert this multi-vertex check into a point-based representation by applying a shrinkage process.
We first compute a new hyperplane H i 1 parallel to H i , located at the distance from the vehicle’s rear axle:
H i 1 = a i T b i 1 .
We also define H i 2 , where the vehicle’s vertex would collide with the original hyperplane:
H i 2 = a i T b i 2 .
The shrinkage criterion requires the contracted hyperplane H i 3 to be as equidistant to H i 1 and H i as H i is to H i 2 . This indicates that once the rear axle of the vehicle reaches the hyperplane H i 3 , the vehicle is at the collision threshold. This criterion ensures that the shrinkage accurately captures the vehicle’s potential collision risk, enabling precise adjustments to avoid obstacles while maintaining a safe and feasible trajectory. Thus, we have the following:
H i 3 = a i T b i b i 1 + b i 2 .
Shrinkage may result in the exclusion of certain trajectory segments, potentially leading to discontinuities in the feasible region. To ensure the continuity of the trajectory, it is essential to verify that each segment of the piecewise path remains fully contained within the boundaries of the shrunken polygon. To accomplish this, we introduce a feasibility check step: for each half-space H i 3 , we calculate the minimum distance from the trajectory segment to the hyperplane. The modified hyperplane H i 4 is represented as follows:
H i 4 = a i T b i b i 1 + b i 2 m i n ( 0 , d i s t ( , H i 3 ) ) = a i T b i c .
This guarantees continuous and feasible paths. The final convex constraint for obstacle avoidance is as follows:
S = i = 0 n H i 4 = { | A T < b c } .
Additionally, we introduce a soft constraint to enhance obstacle avoidance. While the hard constraints ensure safety in scenarios where a collision is imminent, in practice, trajectory planning also seeks to maximize the distance from nearby obstacles whenever feasible. To achieve this, we introduce a safety margin parameter s i and shift the hyperplane accordingly. This results in a soft constraint that encourages the vehicle to maintain a safer buffer b i s from obstacles:
H i 5 = a i T + s i b i s , b i s b i c s i 0 .
The optimization variables are now extended as x = [ u ¯ , s ] , where
u ¯ = u ˜ 0 u ˜ 1 u ˜ N 1 , s = s 0 s 1 s n .
With this, the convex optimization problem formulation is complete. The flow of the optimization framework is detailed in Algorithm 1. The proposed trajectory planning algorithm involves several sequential modules: geometric preprocessing (ellipse and corridor generation), linearized kinematic update, and final convex optimization via model predictive control (MPC). The detailed time complexity analysis is provided in Table 2.
Algorithm 1: Convex optimization-based trajectory planning.
Electronics 14 02929 i001
Let T denote the number of waypoints in the coarse trajectory. O the average number of nearby obstacles per point, and H the number of hyperplanes generated during corridor refinement. The MPC optimization horizon is N, and the final convex problem has n variables and m constraints. The total computational complexity of the algorithm is as follows:
O T · ( O + H ) + N + n p , where p [ 1 , 3 ] ,
where p depends on the choice of QP solver. This expression reflects the linear growth with trajectory length and obstacle density, and a convex QP solver-dependent cost for the MPC step. In practice, since N and n are moderate and modern solvers like OSQP exhibit near-linear performance, the entire algorithm remains suitable for real-time execution in urban driving scenarios.

5. Implementation and Experiments

In this section, we evaluate the effectiveness of the proposed convex optimization algorithm in terms of feasibility and trajectory quality.

5.1. Kinematic Model Comparison

First, we compare two vehicle kinematic models (the original model Equation (1) that wildly used in previous works vs. the modified model Equation (8) that was proposed in our work) using identical initial conditions and control inputs. The scenario involved a vehicle starting from rest at the origin ( 0 , 0 ) , initially facing along the positive x-axis. A constant acceleration (a = 1 m/s2) and a fixed steering angle ( δ = 0.15 rad) were applied over time. As shown in Figure 5, the original model (blue dashed line) shows no displacement in the X direction until around 0.4 seconds, maintaining a nearly constant position despite the presence of acceleration. In contrast, the modified model (red solid line) exhibits noticeable displacement starting as early as 0.2 seconds, indicating an earlier and more accurate response to the applied control input. This comparative simulation highlights critical differences between the original and modified kinematic vehicle models. The modified model more accurately captures the nuanced effects of acceleration and steering inputs on vehicle trajectories, position, and heading angle. Such detailed modeling is crucial for precise prediction and control applications in real-world applications. This behavior highlights the improved sensitivity and dynamic fidelity of the modified model, making it more suitable for real-time trajectory prediction in early motion stages.
To evaluate the computational efficiency of the proposed kinematic model, we conducted 100 repeated simulations for both the original and modified models under identical conditions. The execution time for each trajectory planning run was recorded. A boxplot (see Figure 6) visualizes the distribution of execution times for both models. The modified model achieves slightly lower average time with reduced variance, indicating better runtime stability. The statistical summary of execution time is presented in Table 3. Our key observations are as follows:
  • Similar overall distribution: Both models show tightly clustered execution times, mostly between 0.08 ms and 0.14 ms.
  • Slightly higher stability in the modified model: While a few extreme outliers above 0.3 ms are observed in both cases, the modified model exhibits a narrower box and fewer outliers, suggesting more consistent performance.
  • Real-time feasibility: Both models achieve average execution times well below 1 ms.
Despite incorporating more complex dynamics, the modified kinematic model does not introduce a noticeable increase in computational load. In fact, it demonstrates slightly better runtime stability while maintaining comparable average execution time. This supports its practicality for real-time trajectory optimization in urban autonomous driving scenarios.

5.2. Evaluation in Representative Driving Scenarios

To demonstrate the performance of the proposed optimization method, two representative driving scenarios are considered: (1) the ego vehicle yielding to a cut-in vehicle, as shown in Figure 7, and (2) overtaking a slower vehicle, as shown in Figure 8.
The experiments are conducted in C++ on a laptop equipped with an Intel Core i7-12700 CPU. The OSQP solver is used to implement the optimization process. The planning horizon is 4 s. Initially, a coarse trajectory is generated using the hybrid A* algorithm. Subsequently, this initial guess was refined using the proposed convex optimization method, enhancing the trajectory’s smoothness, safety, and accuracy significantly. The optimization parameters are shown in Table 4.

5.2.1. Lane-Following Scenario

In the lane-following scenario illustrated in Figure 7, the ego vehicle demonstrates the ability to dynamically adjust its trajectory when another vehicle unexpectedly cuts in. The optimized trajectory exhibits smooth maneuvering, ensuring safety without sacrificing passenger comfort. Figure 7 clearly displays the vehicle trajectory, velocity profiles, acceleration patterns, heading angles, and front wheel angles, each indicating smooth and stable control behavior under dynamic constraints.

5.2.2. Lane-Changing Scenario

The lane-changing scenario (Figure 8) further validates the robustness of the proposed method in densely populated dynamic environments. This scenario simulates overtaking maneuvers where the ego vehicle needs to smoothly transition between lanes, maintaining optimal speeds and managing clearances from nearby vehicles. The detailed visualization of trajectory and associated vehicle dynamics such as speed, acceleration, heading, and steering angles confirms the effectiveness and reliability of the optimization-based planning method in realistic driving conditions.
To further evaluate passenger comfort and dynamic smoothness, we computed the jerk profiles for both lane-following and lane-changing scenarios. The resulting statistics are summarized in Table 5. For the lane-changing case, the mean jerk was −0.15 m/s3 with a low standard deviation of 0.08 m/s3, indicating smooth transitions. For the lane-following case, a slightly higher mean jerk of −0.23 m/s3 and a standard deviation of 0.40 m/s3 were observed, reflecting stronger deceleration phases. In both cases, peak jerk values remain well within acceptable comfort thresholds for urban driving. These results confirm that the proposed optimization method produces not only dynamically feasible but also comfort-aware trajectories.

5.3. Computational Efficiency

The flame graph in Figure 9 illustrates the computational efficiency of the algorithm, showing the distribution of execution time among the different functions involved in trajectory optimization. In particular, the primary optimization function (planning::optimize::MPCOptimizer::OptimizeTrajectory) consumes only 0.88% of the total computational resources. This highlights the applicability of the proposed algorithm in real-time, which is essential for practical deployment in autonomous vehicles.
Figure 10 presents a comparative analysis of time consumption across iterations for two optimization strategies: nonlinear optimization [24] and proposed convex optimization. The x-axis denotes the planning iteration index, while the y-axis represents the time cost in milliseconds. Each data series is accompanied by a horizontal dashed line indicating its mean value.
The nonlinear optimization, plotted in blue, demonstrates relatively stable behavior across approximately 1800 iterations. The data are mostly concentrated between 30 and 36 ms, suggesting consistent performance but with a substantial computational cost. The average time cost is approximately 33.34 ms, as indicated by the blue dashed line. This high computational burden is attributed to the complexity of the nonlinear solver and the dimensionality of the optimization problem.
In contrast, the convex optimization process (shown in red) exhibits significantly lower time consumption, with an average of 9.47 ms per iteration. While the data show more pronounced variation than the nonlinear method, they remain bound within a practical range, typically oscillating between 8 and 12 ms. This result implies that the convex formulation offers a substantial improvement in computational efficiency, reducing average execution time by approximately 70% compared to the nonlinear alternative.
Despite the increased variance in the convex optimization time, the trade-off in favor of faster computation may make it more suitable for time-sensitive applications, such as real-time systems. Conversely, the nonlinear optimization may be preferable in offline computation.

5.4. Feasibility and Safety Analysis

Across a comprehensive set of tested scenarios, including varying curves, merging and diverging situations, and narrow roads, the proposed algorithm consistently generates feasible and safe trajectories. Convex polygons represent the feasible regions at each timestep, ensuring obstacle-free navigation through dynamic environments. The overlap between adjacent polygons guarantees continuity, allowing for seamless trajectory transitions over time. The experimental evaluations provided compelling evidence of the algorithm’s strengths:
  • The spatial corridor generation framework significantly enhances safety, effectively addressing dynamic obstacle avoidance through both hard and soft constraints. This ensures vehicle trajectories maintain appropriate clearances from obstacles at all times.
  • The formulation of convex optimization is vital for achieving efficient and reliable solutions. It not only guarantees global optimality but also supports real-time operations, critical for urban driving applications.

5.5. Discussion

The experimental results reinforce the effectiveness of the proposed algorithm in real-world scenarios, emphasizing its potential for practical deployment in autonomous driving systems. In future work, we aim to address several limitations and extend the proposed framework in multiple directions. First, to improve adaptability in inherently non-convex environments, SCP or iLQR will be considered. Additionally, we plan to incorporate dynamic obstacle interaction models—such as intention-aware predictors or game-theoretic frameworks—to better handle cooperative scenarios involving other vehicles or pedestrians. Furthermore, we intend to extend and incorporate estimation and uncertainty handling via risk-aware methods to account for sensor noise and partial observability. Finally, learning-based planning modules (e.g., L-MPC or imitation learning) and adaptive driving styles will be explored to improve generalization across diverse environments and user preferences.

6. Conclusions

Trajectory planning in autonomous driving faces inherent complexities due to non-convex obstacle avoidance regions, dynamic environmental constraints, and nonlinear objective functions. To effectively address these challenges, this paper has introduced a novel convex optimization framework tailored for trajectory planning in complex urban driving scenarios. By integrating a newly developed extended vehicle kinematic model, our approach accurately reflects dynamic vehicle behaviors, including effects of acceleration and steering inputs, improving trajectory prediction and responsiveness.
Another key innovation presented is the convexification of obstacle constraints using free-space corridor techniques, which simplifies the challenging non-convex optimization problem into a solvable convex form. Furthermore, embedding the planning method within a linearized model predictive control (MPC) framework ensures computational efficiency and facilitates real-time applicability crucial for urban driving environments. Experimental evaluations conducted in various driving scenarios, ranging from lane following with sudden vehicle interactions to complex lane changing, demonstrate the robustness and effectiveness of our proposed method. These experiments have illustrated improvements in trajectory smoothness, safety margins, and real-time computational performance. The method consistently produces collision-free and dynamically feasible trajectories while maintaining high computational efficiency, making it highly suitable for deployment in real-world autonomous driving systems.
Overall, the proposed convex optimization approach represents a balanced trade-off among computational efficiency, safety, trajectory smoothness, and dynamic adaptability. Future research directions include extending this method to consider environmental uncertainties, sensor data integration, and robustness against dynamic changes in traffic flow and road conditions, thus further enhancing its practical utility in more demanding real-world scenarios.

Author Contributions

X.S. and S.C. contributed equally to this work. They jointly developed the methodology, conducted data analysis, and wrote the main manuscript. Q.L. provided the conceptual framework, supervised the research, and revised the manuscript. All authors have read and agreed to the published version of the manuscript.

Funding

This work was supported in part by the Science and Technology Innovation Key R&D Program of Chongqing under Grant CSTB2023TIAD-STX0030; in part by the Shenzhen Science and Technology Program under Grant KJZD20240903103806009 and Grant KCXFZ20240903093911016; in part by Guangdong Province Key Field R&D Plan Project under Grant 2022B0701180001; and in part by Guangdong Province Advanced Manufacturing Development Special Fund (Industrial Foundation Reconstruction) Project.

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Data Availability Statement

The raw data supporting the conclusions of this article will be made available by the authors on request.

Acknowledgments

The authors would like to acknowledge Shenzhen Campus of Sun Yat-sen University for the financial support in carrying out this research.

Conflicts of Interest

The authors declare that they have no competing interests.

Abbreviations

The following abbreviations are used in this manuscript:
AVAutonomous Vehicle
MPCModel Predictive Control
SCPSequential Convex Programming
QPQuadratic Programming
OSQPOperator Splitting Quadratic Program solver
RRTRapidly Exploring Random Tree
A*A-Star Algorithm
HD mapHigh-Definition Map
iLQRIterative Linear Quadratic Regulator

References

  1. Gerdts, M.; Karrenberg, S.; Müller-Beßler, B.; Stock, G. Generating locally optimal trajectories for an automatically driven car. Optim. Eng. 2009, 10, 439–463. [Google Scholar] [CrossRef]
  2. Hegedűs, T.; Németh, B.; Gáspár, P. Design of a Low-complexity Graph-Based Motion-Planning Algorithm for Autonomous Vehicles. Appl. Sci. 2020, 10, 7716. [Google Scholar] [CrossRef]
  3. Dolgov, D.A.; Thrun, S.; Montemerlo, M.; Diebel, J. Path Planning for Autonomous Vehicles in Unknown Semi-structured Environments. Int. J. Robot. Res. 2010, 29, 485–501. [Google Scholar] [CrossRef]
  4. Frazzoli, E.; Dahleh, M.; Feron, E. Maneuver-based motion planning for nonlinear systems with symmetries. IEEE Trans. Robot. 2005, 21, 1077–1091. [Google Scholar] [CrossRef]
  5. Zhang, Y.; Cui, C.; Zhao, Q. Path Planning of Mobile Robot Based on A Star Algorithm Combining DQN and DWA in Complex Environment. Appl. Sci. 2025, 15, 4367. [Google Scholar] [CrossRef]
  6. Cao, Y.; Li, B.; Deng, Z.; Guo, X. Parking Trajectory Planning for Autonomous Vehicles Under Narrow Terminal Constraints. Electronics 2024, 13, 5041. [Google Scholar] [CrossRef]
  7. Ran, K.; Wang, Y.; Fang, C.; Chai, Q.; Dong, X.; Liu, G. Improved RRT* Path-Planning Algorithm Based on the Clothoid Curve for a Mobile Robot Under Kinematic Constraints. Sensors 2024, 24, 7812. [Google Scholar] [CrossRef] [PubMed]
  8. Ma, L.; Xue, J.; Kawabata, K.; Zhu, J.; Ma, C.; Zheng, N. Efficient Sampling-Based Motion Planning for On-Road Autonomous Driving. IEEE Trans. Intell. Transp. Syst. 2015, 16, 1961–1976. [Google Scholar] [CrossRef]
  9. Naresh Kumar, G.; Ikram, M.; Sarkar, A.; Talole, S. Hypersonic flight vehicle trajectory optimization using pattern search algorithm. Optim. Eng. 2018, 19, 125–161. [Google Scholar] [CrossRef]
  10. Ziegler, J.; Bender, P.; Dang, T.; Stiller, C. Trajectory planning for Bertha—A local, continuous method. In Proceedings of the 2014 IEEE Intelligent Vehicles Symposium Proceedings, Dearborn, MI, USA, 8–11 June 2014; pp. 450–457. [Google Scholar] [CrossRef]
  11. Huang, C.; Huang, H.; Hang, P.; Gao, H.; Wu, J.; Huang, Z.; Lv, C. Personalized Trajectory Planning and Control of Lane-Change Maneuvers for Autonomous Driving. IEEE Trans. Veh. Technol. 2021, 70, 5511–5523. [Google Scholar] [CrossRef]
  12. Geng, S.; Wang, Q.; Xie, L.; Xu, C.; Cao, Y.; Gao, F. Robo-Centric ESDF: A Fast and Accurate Whole-Body Collision Evaluation Tool for Any-Shape Robotic Planning. In Proceedings of the 2023 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Detroit, MI, USA, 1–5 October 2023; pp. 290–297. [Google Scholar] [CrossRef]
  13. Zhou, B.; Gao, F.; Wang, L.; Liu, C.; Shen, S. Robust and Efficient Quadrotor Trajectory Generation for Fast Autonomous Flight. IEEE Robot. Autom. Lett. 2019, 4, 3529–3536. [Google Scholar] [CrossRef]
  14. Ding, W.; Zhang, L.; Chen, J.; Shen, S. Safe Trajectory Generation for Complex Urban Environments Using Spatio-Temporal Semantic Corridor. IEEE Robot. Autom. Lett. 2019, 4, 2997–3004. [Google Scholar] [CrossRef]
  15. Deolasee, S.; Lin, Q.; Li, J.; Dolan, J.M. Spatio-temporal Motion Planning for Autonomous Vehicles with Trapezoidal Prism Corridors and Bézier Curves. In Proceedings of the 2023 American Control Conference (ACC), San Diego, CA, USA, 31 May–2 June 2023; pp. 3207–3214. [Google Scholar] [CrossRef]
  16. Li, B.; Acarman, T.; Zhang, Y.; Ouyang, Y.; Yaman, C.; Kong, Q.; Zhong, X.; Peng, X. Optimization-Based Trajectory Planning for Autonomous Parking with Irregularly Placed Obstacles: A Lightweight Iterative Framework. IEEE Trans. Intell. Transp. Syst. 2022, 23, 11970–11981. [Google Scholar] [CrossRef]
  17. Li, B.; Ouyang, Y.; Li, L.; Zhang, Y. Autonomous Driving on Curvy Roads Without Reliance on Frenet Frame: A Cartesian-Based Trajectory Planning Method. IEEE Trans. Intell. Transp. Syst. 2022, 23, 15729–15741. [Google Scholar] [CrossRef]
  18. Fan, H.; Zhu, F.; Liu, C.; Zhang, L.; Zhuang, L.; Li, D.; Zhu, W.; Hu, J.; Li, H.; Kong, Q. Baidu Apollo EM Motion Planner. arXiv, 2018; arXiv:1807.08048. [Google Scholar] [CrossRef]
  19. Zhang, M.; Tong, L.; Zhao, L.; Wang, P. Collision Avoidance Trajectory Planning Based on Dynamic Spatio-Temporal Corridor Search in Curvy Road Scenarios for Intelligent Vehicles. Electronics 2024, 13, 4959. [Google Scholar] [CrossRef]
  20. Werling, M.; Ziegler, J.; Kammel, S.; Thrun, S. Optimal trajectory generation for dynamic street scenarios in a Frenét Frame. In Proceedings of the 2010 IEEE International Conference on Robotics and Automation, Anchorage, AK, USA, 3–7 May 2010; pp. 987–993. [Google Scholar] [CrossRef]
  21. Lim, W.; Lee, S.; Sunwoo, M.; Jo, K. Hierarchical Trajectory Planning of an Autonomous Car Based on the Integration of a Sampling and an Optimization Method. IEEE Trans. Intell. Transp. Syst. 2018, 19, 613–626. [Google Scholar] [CrossRef]
  22. Manzinger, S.; Pek, C.; Althoff, M. Using Reachable Sets for Trajectory Planning of Automated Vehicles. IEEE Trans. Intell. Veh. 2021, 6, 232–248. [Google Scholar] [CrossRef]
  23. Liniger, A.; Domahidi, A.; Morari, M. Optimization-based autonomous racing of 1:43 scale RC cars. Optim. Control Appl. Methods 2014, 36, 628–647. [Google Scholar] [CrossRef]
  24. Han, Z.; Wu, Y.; Li, T.; Zhang, L.; Pei, L.; Xu, L.; Li, C.; Ma, C.; Xu, C.; Shen, S.; et al. An Efficient Spatial-Temporal Trajectory Planner for Autonomous Vehicles in Unstructured Environments. IEEE Trans. Intell. Transp. Syst. 2024, 25, 1797–1814. [Google Scholar] [CrossRef]
  25. Rathinam, M.; Murray, R.M.; Sluis, W.M. Differential Flatness of Mechanical Control Systems: A Catalog of Prototype Systems. In Proceedings of the ASME International Mechanical Engineering Congress and Exposition, San Francisco, CA, USA, 12–17 November 1995. [Google Scholar]
Figure 1. A typical urban driving scenario: (a) 3D view and (b) 2D view. The feasible region is defined by environmental constraints, including road boundaries as well as static and dynamic obstacles, within which a collision-free trajectory is optimized.
Figure 1. A typical urban driving scenario: (a) 3D view and (b) 2D view. The feasible region is defined by environmental constraints, including road boundaries as well as static and dynamic obstacles, within which a collision-free trajectory is optimized.
Electronics 14 02929 g001
Figure 2. Visualization of three trajectory planning approaches in autonomous driving. (a) Search-based planning (e.g., A*) constructs a discrete path through a grid, suitable for structured or partially known environments. Obstacle regions are explicitly avoided using graph traversal. (b) Sampling-based planning (e.g., RRT and lattice planner) samples candidate trajectories toward various goal states and selects the optimal one based on predefined cost metrics such as smoothness, safety, or distance. (c) Optimization-based planning (e.g., MPC) formulates the entire trajectory as an optimization problem under dynamic and safety constraints, generating globally smooth and feasible paths with high adaptability to urban driving.
Figure 2. Visualization of three trajectory planning approaches in autonomous driving. (a) Search-based planning (e.g., A*) constructs a discrete path through a grid, suitable for structured or partially known environments. Obstacle regions are explicitly avoided using graph traversal. (b) Sampling-based planning (e.g., RRT and lattice planner) samples candidate trajectories toward various goal states and selects the optimal one based on predefined cost metrics such as smoothness, safety, or distance. (c) Optimization-based planning (e.g., MPC) formulates the entire trajectory as an optimization problem under dynamic and safety constraints, generating globally smooth and feasible paths with high adaptability to urban driving.
Electronics 14 02929 g002
Figure 3. Schematic of the planar bicycle–kinematic model.
Figure 3. Schematic of the planar bicycle–kinematic model.
Electronics 14 02929 g003
Figure 4. Flowchart of the proposed convex optimization-based trajectory planning framework. The process integrates a model predictive control (MPC) module for feasibility and a feasible area generation module for spatial safety.
Figure 4. Flowchart of the proposed convex optimization-based trajectory planning framework. The process integrates a model predictive control (MPC) module for feasibility and a feasible area generation module for spatial safety.
Electronics 14 02929 g004
Figure 5. Evolution of the trajectory over time for two kinematic models under the same control input. (a) X position over time, (b) Y Position over time, and (c) heading angle over time.
Figure 5. Evolution of the trajectory over time for two kinematic models under the same control input. (a) X position over time, (b) Y Position over time, and (c) heading angle over time.
Electronics 14 02929 g005
Figure 6. Boxplot comparing the execution time of the original and modified kinematic models over 100 simulation runs.
Figure 6. Boxplot comparing the execution time of the original and modified kinematic models over 100 simulation runs.
Electronics 14 02929 g006
Figure 7. Illustration of lane-following case: (a) scene 3D view, (b) scene 2D view, (c) trajectory (m), (d) velocity (m/s), (e) acceleration (m/s2), (f) heading (rad), and (g) front wheel angle (rad).
Figure 7. Illustration of lane-following case: (a) scene 3D view, (b) scene 2D view, (c) trajectory (m), (d) velocity (m/s), (e) acceleration (m/s2), (f) heading (rad), and (g) front wheel angle (rad).
Electronics 14 02929 g007
Figure 8. Illustration of lane-changing case: (a) scene 3D view, (b) scene 2D view, (c) trajectory (m), (d) velocity (m/s), (e) acceleration (m/s2), (f) heading (rad), and (g) front wheel angle (rad).
Figure 8. Illustration of lane-changing case: (a) scene 3D view, (b) scene 2D view, (c) trajectory (m), (d) velocity (m/s), (e) acceleration (m/s2), (f) heading (rad), and (g) front wheel angle (rad).
Electronics 14 02929 g008
Figure 9. Function-level distribution of execution time during trajectory optimization.
Figure 9. Function-level distribution of execution time during trajectory optimization.
Electronics 14 02929 g009
Figure 10. Optimization time during trajectory planning.
Figure 10. Optimization time during trajectory planning.
Electronics 14 02929 g010
Table 1. Comparison of Cartesian and Frenet frames for trajectory planning.
Table 1. Comparison of Cartesian and Frenet frames for trajectory planning.
AspectCartesian FrameFrenet Frame
Coordinate Definition x , y s (longitudinal), l (lateral)
ReferenceGlobal map frameRelative to a centerline
Trajectory RepresentationDirect position in 2D spaceLongitudinal progression and lateral deviation
Obstacle ModelingObstacles described globallyProjected into path-relative coordinates
Kinematic ModelingAccurate but typically nonlinearSimplified under path-aligned assumptions
Optimization ComplexityHigher due to coupling of x, yLower due to path-speed decoupling
Preferred ScenariosComplex or unstructured environmentsStructured roads with clear lane geometry
Table 2. Time-complexity analysis of the proposed algorithm.
Table 2. Time-complexity analysis of the proposed algorithm.
ComponentDescriptionComplexity
Ellipse generationGeometric expansion until collision O ( O )
Corridor shrinkageHyperplane refinement per waypoint O ( H )
Waypoint iterationIterate over coarse trajectory of length T O ( T · ( O + H ) )
Kinematic updateState propagation over horizon N O ( N )
MPC optimizationQP solver with n variables, m constraints O ( n p ) , p [ 1 , 3 ]
TotalOverall end-to-end complexity O ( T ( O + H ) + N + n p )
Table 3. Statistical summary of execution time (in milliseconds).
Table 3. Statistical summary of execution time (in milliseconds).
MetricOriginal ModelModified Model
Minimum0.077960.07820
Maximum0.317100.32663
Mean0.101500.09536
Median0.081180.08082
Standard Deviation0.039250.03038
Table 4. Parameter configuration for trajectory optimization.
Table 4. Parameter configuration for trajectory optimization.
SymbolDescriptionValueUnit
L r Length of rear axle0.615m
L f Length of front axle0.965m
L w Vehicle width1.800m
LWheelbase2.920m
v n Navigation speed limitderived from HD mapm/s
Δ t Time step0.200s
v m i n Lower bound of velocity0m/s
v m a x Upper bound of velocity v n m/s
a m i n Lower bound of acceleration−5.0m/s2
a m a x Upper bound of acceleration2.0m/s2
a ˙ m i n Lower bound of jerk−5.0m/s3
a ˙ m a x Upper bound of jerk5.0m/s3
κ m a x Max curvaturederived from velocitym−1
Table 5. Jerk statistics for lane-changing and lane-following scenarios.
Table 5. Jerk statistics for lane-changing and lane-following scenarios.
ScenarioMean Jerk (m/s3)Max Jerk (m/s3)Min Jerk (m/s3)Std Dev (m/s3)
Lane Changing 0.15 0.02 0.27 0.08
Lane Following 0.23 0.21 0.96 0.40
Disclaimer/Publisher’s Note: The statements, opinions and data contained in all publications are solely those of the individual author(s) and contributor(s) and not of MDPI and/or the editor(s). MDPI and/or the editor(s) disclaim responsibility for any injury to people or property resulting from any ideas, methods, instructions or products referred to in the content.

Share and Cite

MDPI and ACS Style

Song, X.; Chen, S.; Liu, Q. Convex Optimization-Based Constrained Trajectory Planning for Autonomous Vehicles. Electronics 2025, 14, 2929. https://doi.org/10.3390/electronics14152929

AMA Style

Song X, Chen S, Liu Q. Convex Optimization-Based Constrained Trajectory Planning for Autonomous Vehicles. Electronics. 2025; 14(15):2929. https://doi.org/10.3390/electronics14152929

Chicago/Turabian Style

Song, Xiaoxiao, Songming Chen, and Qiang Liu. 2025. "Convex Optimization-Based Constrained Trajectory Planning for Autonomous Vehicles" Electronics 14, no. 15: 2929. https://doi.org/10.3390/electronics14152929

APA Style

Song, X., Chen, S., & Liu, Q. (2025). Convex Optimization-Based Constrained Trajectory Planning for Autonomous Vehicles. Electronics, 14(15), 2929. https://doi.org/10.3390/electronics14152929

Note that from the first issue of 2016, this journal uses article numbers instead of page numbers. See further details here.

Article Metrics

Back to TopTop