Next Article in Journal
Dynamic Closed-Loop Validation of a Hardware-in-the-Loop Testbench for Parallel Hybrid Electric Vehicles
Previous Article in Journal
Research on Robust Adaptive Model Predictive Control Based on Vehicle State Uncertainty
Previous Article in Special Issue
Improved Quintic Polynomial Autonomous Vehicle Lane-Change Trajectory Planning Based on Hybrid Algorithm Optimization
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Inverse Dynamics-Based Motion Planning for Autonomous Vehicles: Simultaneous Trajectory and Speed Optimization with Kinematic Continuity

Department of Civil Engineering, Toronto Metropolitan University, 350 Victoria Street, Toronto, ON M5B 2K3, Canada
*
Author to whom correspondence should be addressed.
World Electr. Veh. J. 2025, 16(5), 272; https://doi.org/10.3390/wevj16050272
Submission received: 12 April 2025 / Revised: 5 May 2025 / Accepted: 9 May 2025 / Published: 14 May 2025
(This article belongs to the Special Issue Motion Planning and Control of Autonomous Vehicles)

Abstract

:
This article presents an alternative variant of motion planning techniques for autonomous vehicles (AVs) centered on an inverse approach that concurrently optimizes both trajectory and speed. This method emphasizes searching for a trajectory and distributing its speed within a single road segment, regarded as a final element. The references for the road lanes are represented by splines that interpolate the path length, derivative, and curvature using Cartesian coordinates. This approach enables the determination of parameters at the final node of the road segment while varying the reference length. Instead of directly modeling the trajectory and velocity, the second derivatives of curvature and speed are modeled to ensure the continuity of all kinematic parameters, including jerk, at the nodes. A specialized inverse numerical integration procedure based on Gaussian quadrature has been adapted to reproduce the trajectory, speed, and other key parameters, which can be referenced during the motion tracking phase. The method emphasizes incorporating kinematic, dynamic, and physical restrictions into a set of nonlinear constraints that are part of the optimization procedure based on sequential quadratic optimization. The objective function allows for variation in multiple parameters, such as speed, longitudinal and lateral jerks, final time, final angular position, final lateral offset, and distances to obstacles. Additionally, several motion planning variants are calculated simultaneously based on the current vehicle position and the number of lanes available. Graphs depicting trajectories, speeds, accelerations, jerks, and other relevant parameters are presented based on the simulation results. Finally, this article evaluates the efficiency, speed, and quality of the predictions generated by the proposed method. The main quantitative assessment of the results may be associated with computing performance, which corresponds to time costs of 0.5–2.4 s for an average power notebook, depending on optimization settings, desired accuracy, and initial conditions.

1. Introduction

Motion planning is a crucial part of self-driving vehicles. It ensures safe navigation of vehicles and effectively guides in busy and changing areas. Unlike human drivers, self-driving vehicles utilize specialized algorithms to determine the most efficient route from their starting point to their destination. They must avoid obstacles, follow traffic laws, and ensure passengers feel comfortable. Motion planning involves two primary tasks: determining a route and controlling the vehicle’s movements. The safe paths are generated by considering the vehicle’s capabilities, the surroundings, and other road users. Effective motion planning also helps save energy, reduce travel time, and provide a smoother ride. As these vehicles begin to operate in increasingly complex city and highway environments, advanced motion planning techniques are crucial for ensuring their safe and reliable use in everyday transportation. This section presents a literature review of existing motion planning techniques, identifying gaps and outlining the scope of the present study.

1.1. Literature Review

Cutting-edge solutions for motion planning in autonomous vehicles (AVs) have emerged, with many of these advancements reflected in comprehensive overviews of current approaches [1,2]. Existing studies were grouped into five categories based on their key focus: dynamic motion planning, obstacle avoidance, real-time planning, modeling and control, and trajectory optimization. Table 1 presents a structured overview of the studies, highlighting their methodologies, application context, strengths, and limitations.
The dynamic motion planning studies focused on high-fidelity vehicle dynamics modeling for real-time motion planning. Jiang et al. [3] proposed a driving corridor generation method to implement boundary constraints. It first generated a piecewise quintic polynomial reference line by formulating an optimization problem. The objective function included the lateral offset and the first and second derivatives of the lateral offset. Thus, a collision-free reference line was obtained using quadratic optimization (QO). Then, a feasible and smooth path is generated by iterative optimization using sequential quadratic optimization (SQO). Dang et al. [4] proposed a coupled dynamics motion planner that integrated a unified vehicle model, model predictive control (MPC)-based optimization, and slip-aware safety margins. The key advantages of their method include high-speed stability, real-time performance, and accommodating emergency maneuvers. This study appears to be the first to embed Pacejka tire models directly into MPC constraints and introduce a dynamics-adaptive corridor that shrinks/expands with road friction.
Li et al. [5] developed a real-time convex optimization planner that reformulated nonconvex collision avoidance as a series of quadratic programs, featuring Iterative convexification, kinematic feasibility, and warm-start acceleration. The method had several key advantages, including guaranteed collision avoidance, hardware validation, and excellent urban performance. Tang et al. [6] developed a closed-loop motion planner using a Takagi–Sugeno (T-S) fuzzy model to handle nonlinear vehicle dynamics. The method featured adaptive trajectory generation, obstacle avoidance, and MPC. The model accounted for tire saturation and load transfer during aggressive maneuvers and effectively generated paths to avoid both static and dynamic obstacles. The method was validated using CarSim with 90% fewer lane boundary violations than linear MPC.
The obstacle avoidance studies focused on safe navigation in static and dynamic environments. Liniger and Gool [7] developed a game-theoretic motion planner that treated the road as an adversarial agent, combining adversarial road modeling, Hamilton–Jacobi reachability, and real-time adaptation. The method guaranteed collision avoidance even with 15% sensor error, explicitly modeled tire force constraints, and was computationally tractable. The method was demonstrated on a full-scale autonomous race car at 120 km/h, showing 60% fewer emergency stops than MPC baselines. Yang et al. [8] proposed a risk-aware path-planning method for autonomous vehicles that combined Bézier curves with an artificial potential field (APF) to enhance safety in dynamic environments. The approach evaluated collision risks by integrating driver behavior models (e.g., aggressive/normal driving styles) and assigned risk values to potential paths.
Hu et al. [9] adapted Frenet frame planning for marine autonomous vehicles, addressing unique challenges such as unpredictable water currents and dynamic vessel traffic. Their method combined Frenet coordinate optimization, quintic polynomial trajectories, and hybrid static/dynamic avoidance. Their method was robust to slippage and computationally light. The authors validated the method with real radar data from Hong Kong harbor scenarios. Jin et al. [10] proposed an improved APF method that overcame classic APF limitations. The potential field functions were composed of three parts: road boundary repulsion field, goal attraction field, and obstacle repulsion field. The trajectory was formed by considering the agents’ positions at each time interval in relation to the target point or time horizon. The velocity update process helped to plan a smooth and collision-free trajectory. Dong et al. [11] presented the Pacejka tire model, which complicated the single-track vehicle model for autonomous vehicle racing. The trajectory optimization problem was formulated in the general nonconvex form, followed by convexification using sequential convex optimization (SCO). The sequential convex restriction was proposed as a method to convexify track constraints. The concept of MPC was used as the control structure.
The real-time planning studies focused on fast, computationally efficient planning for on-road decision-making. Jeng et al. [12] proposed a heuristic search-based motion planner that combined rule-based strategies with real-time adaptability for urban AV navigation. The method leveraged driving behavior templates, dynamic priority weighting, and computational lightness. The authors implemented a fail-safe mechanism and validated the method in simulated dense urban scenarios with mixed traffic. Lu et al. [13] addressed computational bottlenecks in autonomous driving by proposing a decoupled trajectory planner that separated path generation (spatial planning) and velocity profiling (temporal planning). Their key innovations included hierarchical optimization, Frenet frame efficiency, and hardware validation. Cheng et al. [14] introduced a novel trajectory planning framework that combined Gaussian Process (GP) prediction with incremental optimization to enable safe and efficient autonomous driving in dynamic environments. Their key contributions included GP-based prediction, incremental refinement, and dynamic obstacle handling.
Jiang et al. [15] developed a real-time SQO planner that addressed two key challenges: dynamic obstacle uncertainty and kinematic feasibility. The key innovations in their method included an adaptive horizon (adjusting the planning window based on obstacle density), warm-start optimization, and fault detection. The method was validated on a Hong Kong self-driving shuttle with <10 cm tracking error. Li et al. [16] proposed an intuitive steering model based on heuristics of driving behavior to quickly and efficiently generate target paths instead of traditional path planning. Heuristic rules could be used to plan dynamic, feasible, and comfortable trajectories while focusing on customizability. Scheffe et al. [17] developed a high-speed racing planner using sequential convex optimization (SCO) that uniquely addressed nonlinear dynamics linearization, track-adaptive safety, and micro-optimization. The method was demonstrated on a full-scale autonomous race car at 240 km/h and outperformed traditional MPC by 35% in lap-time consistency. In addition, the tire slip angles were maintained within 2° of optimal even during aggressive drifts.
The modeling and control studies focused on innovative approaches for on- and off-road. The early work by Diachuk and Easa [18] established a kinematic-focused planning framework for autonomous vehicles operating in constrained environments (e.g., parking lots, urban alleys). The authors developed geometric-constrained paths, low-speed optimization, and a computationally light algorithm. Pérez-Dattari et al. [19] proposed an imitation learning framework that combined human demonstration data, visual perception, and interactive safety filters. The framework had several key advantages, including naturalistic driving, which captured nuanced human behaviors, generalizability to unseen scenarios, and computational efficiency. The study appears to be the first to fuse neural motion primitives with model-based safety constraints and introduce a social-attention module to prioritize interactive agents.
The four papers by Diachuk and Easa [20,21,22,23] shared a common theme of advancing vehicle dynamics modeling and motion planning through physics-based mathematical optimization, focusing on high-fidelity component-to-system integration. For example, Diachuk and Easa [20] developed a coupled powertrain dynamics model that integrated engine performance with torque converter behavior to enhance vehicle acceleration and driveline efficiency. The authors proposed an integrated modeling framework, conducted a transient response analysis, and validated the proposed method. The transitional study by Diachuk and Easa [24] introduced an inverse dynamics framework for speed profile generation that directly incorporated powertrain limitations, tire–road friction boundaries, and energy efficiency criteria. The authors replaced traditional forward-simulation approaches with a boundary-value formulation and Sliding-mode constraints.
The trajectory optimization studies focused on mathematical optimization for smooth, collision-free, and time-efficient paths. Dorpmüller et al. [25] proposed the B-spline technique not only for trajectory planning but also for defining the upper and lower boundaries of constraints, effectively combining these objectives into a single nonlinear optimization problem. To assess the quality of the lateral motion model, they tracked how the number of breakpoints affected the optimal solution. Wang and Lin [26] developed a Frenet frame-based path planner that transformed complex Cartesian planning problems into simplified 1D longitudinal/lateral optimizations. Their approach featured curvature-continuous trajectories, dynamic obstacle handling, and real-time optimization. The authors introduced a reference line adaptation technique to minimize Frenet approximation errors.
Trauth et al. [27] introduced FRENETIX, a modular motion planner that leveraged Frenet frame optimization with enhanced computational efficiency and adaptability. The framework uniquely combined multi-curvature clothoids, parallelizable architecture, and dynamic adaptability. The method had several key advantages, including performance, modularity, and safety-critical focus. Huang et al. [28] developed a physics-inspired planning framework by reformulating AV trajectory generation as a variational problem, utilizing the principle of least action, Hamiltonian dynamics, and geometric constraints. The authors unified spatial and temporal planning through action-minimizing curves (replacing traditional splines/polynomials).
The two papers by Diachuk and Easa [29,30] shared a unified theme of physics-constrained motion planning for AVs but with distinct emphases. For example, Diachuk and Easa [29] introduced a maneuver-adaptive planning system that generated multiple trajectory–speed candidates in parallel, featuring multi-objective optimization, dynamic feasibility guarantees, and real-time selection logic. This paper extended their earlier work on the inverse dynamics approach to multi-modal planning scenarios. They introduced adaptive Gaussian quadrature for faster numerical integration of jerk constraints. They were the first to demonstrate subsecond computation for five or more maneuver variants, with an average of 0.8 s on consumer hardware.

1.2. Scope and Objectives

This paper addresses critical gaps in AV motion planning by introducing a novel inverse numerical integration-based technique for simultaneously optimizing trajectory and speed. This paper advances the field by addressing several key gaps. First, most existing methods (e.g., Lu et al. [13] and Jiang et al. [15]) treat trajectory and speed planning as separate tasks, resulting in suboptimal or kinematically inconsistent results. This paper unifies both tasks into a single optimization framework, ensuring dynamic feasibility and smoother transitions (e.g., continuous jerk profiles). Second, polynomial/spline-based planners (e.g., Wang and Lin [26]) often sacrifice higher-order continuity (e.g., jerk) for computational speed, while MPC methods (e.g., Dong et al. [11]) are computationally expensive. The proposed inverse approach models curvature and speed derivatives (not direct parameters), enabling C³ continuity (jerk smoothing) with real-time performance (0.5–2.4 s/computation). Third, Frenet frame planners (e.g., Hu et al. [9]) struggle with kinematic inaccuracies, while sampling-based methods (e.g., Tang et al. [6]) overlook vehicle dynamics. In this paper, the hard constraints on tire slip limits, yaw rates, and powertrain dynamics are embedded via nonlinear integrals, bridging the gap between geometric planning and physical realism. Finally, most planners generate a single trajectory, which requires replanning in the event of unexpected obstacles (e.g., Yang et al. [8]). This issue is addressed in this paper by the parallel computation of multiple maneuver variants (lane changes, speed profiles) with real-time selection based on safety and comfort criteria.
The novel contributions of this paper are as follows: (1) a unique focus on the second and third derivatives of curvature and speed, ensuring kinematic consistency; (2) Gaussian quadrature integration, which achieves numerical precision without iterative refinement, unlike the GP method by Cheng et al. [14]; and (3) a unified objective function that balances safety (obstacle distances), comfort (jerk), and efficiency (time/speed) within a single framework. Figure 1 illustrates the proposed approach of this study.

2. Mathematical Modeling

2.1. Representing Sought-For Functions with Piecewise Polynomials

Consider a road segment with the base of length L. Some function y x may describe a parameter within this segment. Let us assume that this function may be represented sufficiently accurately by a Lagrange polynomial of extent p. This polynomial function can be expressed through a set of form functions F and nodal parameters Q, which are the DOFs at the end nodes. Then, one can be written as
A = a 0 a p ,       X = x 0 x p ,       Q = q 1 q p + 1 ,       F = f 1 f p + 1 ,       y x = A T X = Q T F
where aj = polynomial coefficient, j ∈ [0, p]; fj = shape function, and qj = DOF, j ∈ [1, p + 1].
For a two-node element, the polynomial extent p must be odd. Then, considering coordinates [0, L] of the segment ends, it is possible to form matrix B, providing the continuity up to k-th derivative at the nodes [26]:
M = X T d k X T / d x k ,       B = M 0 M L ,       F = B T 1 X
Assuming x = ξL, where parameter ξ ∈ [0, 1], we can pass to the universal basis functions Fξ corresponding to the unitary length. Then, the relations become as follows:
l = L 0 L k ,       L = d i a g l l ,       y x = y Q , L , ξ = Q T L F ξ
Thus, a k-th derivative of the function y(x) may be found as follows:
d k y d x k = Q T L L k d k F ξ d ξ k
In turn, three needed first antiderivatives are as follows:
y d x = Q T L L F ξ d ξ ,     y d x 2 = Q T L L 2 F ξ d ξ 2 ,     y d x 3 = Q T L L 3 F ξ d ξ 3

2.2. Vehicle Kinematics

Assuming the mass center’s trajectory to be formed based on neutral steerability, the longitudinal Vζ and transverse Vμ speeds (Figure 2) may be geometrically related, considering conditionally rigid tires and the absence of sideslip.
The speed V of the vehicle’s mass center C may be decomposed as follows:
V = V τ + 0 ν = V ζ u ζ + V μ u μ = V x u x + V y u y
where τ , ν = unit vectors of the trajectory’s Frenet coordinate system; u ζ , u μ = unit vectors of the vehicle local coordinate system ζμ; u x , u y , Vx, Vy = unit vectors and speed components of the fixed (global) coordinate system xy.
The longitudinal speed Vζ may be easily estimated by the AV sensory system and, consequently, taken as an optimization criterion. To obtain the kinematic parameters characterizing the AV’s dynamics, the following derivatives concerning time t are needed:
d V ζ d t = d V ζ d x d x d t = d V ζ d x V x ,       d 2 V ζ d t 2 = d 2 V ζ d x 2 V x 2 + d V ζ d x d V x d x V x
The absolute speed V ties components Vx and Vζ through the tangent angle α and central slip angle β. Then,
V = d s d t = d s d x d x d t = V x c o s α = V ζ cos β ,       V x = V ζ cos α cos β
The first derivative concerning the x-coordinate is
d V x d x = d V ζ d x + V ζ dx tan β dx tan α cos α cos β
The lateral speed Vμ characterizes the lateral deflection from the longitudinal component Vζ on the central slip angle β:
V μ = V ζ tan β
The derivative concerning time gives
d V μ d t = d V μ d x d x d t = d V μ d x V x ,       d V μ d x = d V ζ d x tan β + V ζ d β dx sec 2 β
d 2 V μ d t 2 = d 2 V μ d x 2 V x + d V μ d x d V x d x V x
d 2 V μ d x 2 = d 2 V ζ d x 2 tan β + V ζ d 2 β d x 2 + 2 d β d x d V ζ d x + V μ d β d x sec 2 β
The yaw rate is the derivation of the yaw angle ϕ = α−β in the current global coordinates. Thus, its expression and derivative component concerning the x-coordinate are
ω = d ϕ d t = d ϕ d x d x d t = d ϕ d x V x ,       d ω d x = d d x d ϕ d x V x = d 2 ϕ d x 2 V x + d V x d x d ϕ d x
The angular acceleration ε is the derivative of the yaw rate ω concerning the time t:
ε = d ω d t = d ω d x d x d t = d ω d x V x = d 2 ϕ d x 2 V x 2 + d V x d x ω
The longitudinal and lateral accelerations in the local vehicle coordinate system ζμ are
a = d V d t = a ζ a μ T u ζ u μ ,       a ζ a μ = d V ζ / d t d V μ / d t + ω V μ       V ζ
The longitudinal and lateral jerks characterize the smoothness of transient processes:
j = d a d t = j ζ j μ T u ζ u μ = d 2 V ζ d t 2 2 d V μ d t + V ζ ω ω ε V μ d 2 V μ d t 2 + 2 d V ζ d t V μ ω ω + ε V ζ T u ζ u μ

3. Motion Planning Models

3.1. Planning Concept

Trajectory and reference. We assume that the AV plans a motion trajectory relative to the lane’s midline on which it is currently located (Figure 3a). Such a reference may be obtained, for example, by the cubic spline interpolation providing a sufficiently smooth model of a road section. For each road section, functional dependencies xr = xr(sr) and yr = yr(sr) can be built. Varying the path length sr relative to the initial value sr0, it is possible to set the values xrf, yrf corresponding to the final lateral displacement Df along the road width. Thus, the coordinates xf and yf of the AV’s mass center’s final position can be calculated as follows:
x f = x r f D f s i n α r f ,       y f = y r f + D f c o s α r f
where αrf = the reference’s tangent slope at the point xrf.
The transverse coordinate D is always perpendicular to the reference curve sr, and the AV’s final angular position on any lane ideally has the same value αrf to keep the motion stable. However, the actual value of the αr angle may, for various reasons, differ from the ideal value associated with the desired angle αd. Though the AV may be located anywhere within the lane width, it is expedient to adhere to some desirable lateral position Dd.
Lanes and Obstacles. Let us consider that the AV moves among other vehicles (Figure 3b). The AV drives in the second (2) lane and may maneuver in three variants, changing the lane for the first (1) or third (3) ones and staying in the second lane. From a safety perspective, the best maneuver involves maintaining a safe distance from moving obstacles whenever possible. At the motion planning moment, the AV fixes the current lane’s midline points in such a way as to build smooth conjugations (splines) that reflect the road bend. Then, considering the number of lanes, longitudinal sr and transverse D coordinates, it is possible to impose a curvilinear grid (interpolation) on the road segment space for which the motion is planned. Using radars, the AV can detect distances to objects and angles of measuring beams. Then, the coordinates of the vehicles’ initial positions may be estimated relative to the AV’s xy coordinate system. We use conditional circles (contours) to form the vehicle safety zone. Thus, three round areas of radius r0 relative to the AV’s front, middle, and rear parts are enough to cover the vehicle contour. The positions of the centers of the front and back parts are calculated as follows:
x c p = x c + h p c o s ϕ ,       y c p = y c + h p s i n ϕ ,       p f , r
where xc, yc = vehicle’s mass center coordinates, hf, hr = distances to the conditional centers of front and rear the vehicle’s parts, respectively, ϕ = yaw angle.
Thus, the positions of impeding vehicles’ centers can be estimated based on radar (camera) measurements. Using them and the predetermined curvilinear grid for a road segment, the lateral locations Di,0 can be found. This helps in detecting a traffic lane corresponding to each obstructive vehicle. Accepting the lane midline as the vehicle’s current trajectory, similarly to the case with AV, it is possible to compose interpolation dependencies xi = xi(si), yi = yi(si), i ∈ [1, Nv], where Nv is the number of fixed vehicles.
Therefore, the vehicles’ motion parameters may be evaluated in discrete time intervals within the total AV’s motion time tf. Accepting for simplicity for the vehicles’ speeds Vi to be constants, the path increments for the intervals Δt are Δsi = ViΔt and for the total time si = Vitf. Knowing the accumulated paths and using the predefined interpolations, the coordinates xi, yi can be found. Considering a radius of safety zones ri, the distance between the AV (0) and an i-th obstructive vehicle is evaluated as follows:
d i = x c p 0 x c p i 2 + y c p 0 y c p i 2 r 0 r i ,       p f , r
where indexes f and r mean front and rear, correspondingly.
Note that for determining the positions of vehicles’ mass centers, it is necessary to identify and estimate their overall dimensions and wheelbase, which complicates the calculations. Instead of this, we shall use front circles for the vehicles behind the AV and rear circles for the vehicles ahead of the AV to conditionally define their centers. The corresponding centers can be easily found by estimating the overall width of a moving obstacle. Then, the needed parameters Di,0 may be replaced with Di,f and Di,r, respectively. Thus, the trajectories of moving obstacles can be considered as the tracks of the centers of the safety contours.

3.2. Trajectory Numerical Modeling

In this technique, unlike the traditional approach, we proceed from the curvature of the trajectory. This must simultaneously reduce the number of parameters to be optimized along with ensuring the smoothness and continuity of the function derivatives. Let us consider a set of needed parameters.
The tangent’s angle α defines the derivative of the mass center’s trajectory:
d y / d x = tan α x
The elementary increment of the arc length along the x-axis is obtained as follows:
d s = s x d x       a n d       s x = 1 + d y / d x 2 = sec α = 1 cos α
In turn, the derivative of the scale parameter s x is
d s x d x = t a n α sec α d α d x = tan α cos α d α d x = s x d α d x tan α = s x d α d x d y d x
The angle α and curvature are related differentially to each other:
K s = d α d s ,       K x = 1 s x d α d x = cos α d α d x
Then, the first and second derivatives may be found as follows:
d α d x = s x K ,       d 2 α d x 2 = d d x d α d x = d d x s x K = K d s x d x + s x d K d x
The central slip angle β is related to the trajectory’s curvature. Considering the distance b from the rear axle to the vehicle mass center, including the instantaneous turning radius R, we obtain
β = arctan V μ / V ζ = arcsin b / R = arcsin b K
The derivative of angle β concerning x, introducing the coefficient kβ:
d β d x = d d x arcsin b K = k β d K d x ,       k β = b 1 b K 2
The second derivative of β relative to x is given by
d 2 β d x 2 = d k β d x d K d x + k β d 2 K d x 2 = k β K d β d x 2 + d 2 K d x 2 ,       d k β d x = k β 3 K d K d x
The derivatives of both α and β include the first and second derivatives of curvature. This implies that to ensure a seamless connection between segments of the planned trajectory, equality up to the 2nd derivative must be provided at transient nodes. Consequently, at least a cubic polynomial is needed for describing curvature’s 2nd derivative within 2 adjacent nodes.
The steered wheels’ turn angles may be found in Ackerman’s geometric relations. Since the trajectory’s curvature K is much less than a curvature value corresponding to the maximum turn angle, the theoretical ratio between these angles is consistent with the steering trapezoid kinematics. Then, the turning angles are defined as follows:
θ 1 = a r c c o t cos β K B 12 B 13 2 B 12 ,       θ 3 = a r c c o t cos β K B 12 + B 13 2 B 12
The α and β angles, along with their first two derivatives, are the most significant geometric parameters determining vehicle kinematics. Unlike the approach of planning the trajectory by polynomials, this technique proceeds from the curvature derivatives while the integration procedures give the trajectory. Since the curvature’s second derivative should satisfy the conditions of uniqueness and smoothness, it may be accepted as the basic modeled function. Thus, the curvature’s third derivative is continuous.
Equation (24) allows for the separation of the differential variables. Then, for the current segment,
K x d x = cos α d α
Thus, based on Equation (30) and introducing an integration constant H0:
K x d x = cos α d α ,       H K = K x d x ,       H K + H 0 = s i n α
The initial angle α0 depends on initial conditions and may differ from zero. The value of antiderivative HK at x = 0 equals 0. Thus, we obtain
H 0 = s i n α 0 H K 0 = s i n α 0
Then, the angle function, considering Equation (31), can be expressed as follows:
α = a r c s i n H ,       H = H K + s i n α 0
In turn, the obvious constraint appears:
H i < 1
Curvature Model. This technique proceeds by modeling the derivative of the second curvature, ensuring continuity up to the third derivative of the curvature. Thus, the cubic polynomial adequately satisfies these conditions. The model requires two nodal DOFs:
q c 0 = d 2 K d x 2 0 d 3 K d x 3 0 ,       q c f = d 2 K d x 2 f d 3 K d x 3 f ,       Q c = q c 0 q c f
where index 0 means the initial node and f means the final node.
Then, according to the general approach in Equation (4), the model and its derivative may be represented as follows:
d 2 K d x 2 = Q c T L F ξ ,       d 3 K i d x 3 = Q c T L L d F ξ d ξ
Consequently, integrating the model, the first curvature derivative can be found:
d K d x = d 2 K d x 2 d x + d K d x 0
where the integration constant d K / d x 0 is defined from initial conditions.
In turn, the first antiderivative is obtained as
d 2 K d x 2 d x = Q c T L F ξ d x = Q c T L L F ξ d ξ
Consequently, the curvature within a road segment is determined by the second integration of Equation (37):
K = d K d x d x + K 0 = d 2 K d x 2 dx + dK dx 0 d x + K 0 =
= d 2 K d x 2 d x 2 + dK dx 0 d x + K 0 = d 2 K d x 2 d x 2 + d K d x 0 x + K 0
where the integration constant K0 means the initial curvature.
Considering Equation (38), the components of Equation (39) are as follows:
d 2 K d x 2 d x 2 = Q c T L L 2 F ξ d ξ 2 ,       d K d x 0 x = L d K d x 0 ξ
Due to Equation (30), there is a need for the third integral. Thus,
K x d x = d 2 K d x 2 d x 2 + dK dx 0 x + K 0 d x + H 0 =
= d 2 K d x 2 d x 3 + d K d x 0 x 2 2 + K 0 x + H 0
where H0 is the integration constant, and other components can be found as follows:
d 2 K d x 2 d x 3 = Q c T L L 3 F ξ d ξ 3 ,       d K d x 0 x 2 2 = L 2 2 d K d x 0 ξ 2 ,       K 0 x = L K 0 ξ
The vectors of curvature, its integrals, and its derivatives can be obtained numerically.
Numerical Integration Technique. To satisfy the requirements of rapid and accurate calculations, a numerical integration method based on the N-point Gaussian quadrature scheme is proposed for use. Assume that some integrand z(x) is considered within a segment [xi−1, xi], then, expressing x = ξL
0 L z x d x = L 0 1 z Q , L , ξ d ξ L k = 1 N w k z ξ ϑ k d e t J ϑ k
where wk = integration weight in the k-th point, ϑkk-th point in the master-element coordinate system, J = Jacobian, k ∈ [1, N], and N = number of integration points.
For one-dimensional FE
ξ ϑ k = ξ 1 ξ 0 2 ϑ k + 1 + ξ 0 = 1 2 ϑ k + 1 ,       d e t J = ξ 1 ξ 0 2 = 1 2
Denoting the vectors,
ϑ = ϑ 1 ϑ N ,       w = w 1 w N , ξ = ξ 1 ξ N T ,       z = z 1 z N T
The short expression for calculating the integral becomes
L 0 1 z Q , L , ξ d ξ L 2 z w
where L = section length and z = vector of integrands of 1 × N size.
Forming the Trajectory. Let us consider a component from Equation (22):
s x = 1 cos α = 1 cos a r c s i n H = 1 1 H 2
Turning back to the trajectory derivative from Equation (21), we obtain
d y d x = tan α x = tan a r c s i n H = H 1 H 2 = H s x = z y x
Separating the variables, we obtain the following form:
d y = z y x d x ,       Δ y = 0 x z y x d x ,       y = Δ y + y 0
where y0 = trajectory’s initial value.
Consider the technique of integrating Equation (49) numerically. For integrating along a specific segment part, the upper integral limit must contain a variable. Assume that it is necessary to obtain the integral values at some discrete points j ∈ [1, N + 1] based on the control integration points k ∈ [1, N]. Then, applying the approach described in Equations (43)–(46), we obtain
Δ y j = x j 1 x j z y x d x = L ξ j 1 ξ j z y L ξ d ξ = L Δ ξ j 0 1 z y L ξ ϑ d ϑ =
= L Δ ξ j 2 k = 1 N z y L ξ j ϑ k w k = L Δ ξ j 2 k = 1 N w k z y L , ξ j , k = L Δ ξ j 2 z y j T w
where zyj = vector of Equation (49) function values in the specified points of master-element for the j-th point.
Combining all increments Δξi in a row vector Δξ, the Equation (46) can be modified as follows:
Δ y = L 2 Δ ξ d i a g z y T w
Equation (51) shows that the trajectory’s increments are accumulated. If an N-point Gaussian integration scheme is used, the calculations are executed at the points ξk, k ∈ [1, N]. In turn, each segment [ξj−1, ξj], j ∈ [1, N + 1] of the master element to be again considered as a new master element with the same specified integration points, i.e., ϑk = ξk. Figure 4 depicts an explanation of the given integration approach.
Performing the procedure of Equation (51), we obtain a vector of increments. That is,
Δ y = Δ y 1 , 1 Δ y 1 , N + 1
Accumulating the sum along columns, the integration points are reflected in the vector
y = 0 y 1 , 1 y 1 , N + 1 + y 0
With an initial point, the vector dimension becomes 1 × N + 2. To unify the optimization computations, the points ϑk and ξk should be assigned identically. Nevertheless, generating the final post-optimization trajectory will obviously require a denser ξ-mesh.

3.3. Speed Distribution Modeling

In this study, we replace direct speed modeling with the indirect one. Studying this approach, we have found it to be highly efficient and flexible. Direct speed modeling either does not satisfy jerk continuity (disruption at transient nodes) or requires a higher extent polynomial model, which is critical in terms of the polynomial’s stability. Thus, we consider the following model variant.
Speed Model. Similarly to Equation (36), the second derivative of the speed is the best choice for providing continuity and smoothness. Then, the model can be written as follows:
d 2 V ζ d x 2 = Q v T L F ξ ,       d 3 V ζ d x 3 = Q v T L L d F ξ d ξ
where nodal parameters are
q v 0 = d 2 V ζ d x 2 0 d 3 V ζ d x 3 0 ,       q v f = d 2 V ζ d x 2 f d 3 V ζ d x 3 f ,       Q v = q v 0 q v f
Thus, the speed’s second derivative model is also based on the cubic polynomial, which conjugates two nodes. Then, the first derivative of the vehicle’s longitudinal speed can be found through the first model’s integral:
d V ζ d x = d 2 V ζ d x 2 d x + d V ζ d x 0
where the integration constant d V ζ / d x 0 is defined from initial conditions.
In turn, the antiderivative is determined as follows:
d 2 V ζ d x 2 d x = Q v T L F ξ d x = Q v T L F ξ L d ξ = Q v T L L F ξ d ξ
Further, the longitudinal speed is defined by repeating the integration of Equation (56):
V ζ = d V ζ d x d x + V ζ 0 = d 2 V ζ d x 2 dx + dV ζ dx 0 d x + V ζ 0 =
= d 2 V ζ d x 2 d x 2 + dV ζ dx 0 d x + V ζ 0 = d 2 V ζ d x 2 d x 2 + d V ζ d x 0 x + V ζ 0
where the integration constant Vζ0 corresponds to the vehicle’s initial speed.
Considering Equation (57), components of Equation (58) are found as follows:
d 2 V ζ d x 2 d x 2 = Q v T L L 2 F ξ d ξ 2 ,       d V ζ d x 0 x = L d V ζ d x 0 ξ

3.4. Full Set of Parameters

Note that we consider one segment with initial (0) and final (f) position points. Each node contains two degrees of freedom (DOFs); thus, we need eight variable parameters for both Qv and Qc to simultaneously plan the trajectory y(x) and speed distribution Vζ(x). The configuration of trajectory and speed distribution within segment L is completely determined by a set of vectors Qv and Qc. At the initial node, the vectors qv0, qc0 are usually known from the previous solution or based on initial conditions. Thus, it is possible to form a set of variable parameters that best reflect both the trajectory shape and the speed distribution.
q = S r f D f d 2 K d x 2 f d 3 K d x 3 f d 2 V ζ d x 2 f d 3 V ζ d x 3 f T ,       Q = Q v Q c T
Note that strict constraints may be imposed on the components of vector q to reduce the number of optimized parameters. For instance, the desirable final values of lateral position Df may be fixed to match the lane’s midline.

4. Optimization Model

4.1. Nonlinear Optimization and Numerical Integration

We assume that an objective function S is represented by the integral quadratic form, including nonlinear constraints. The minimization is based on the SQP method and can be generalized as follows:
min q S q     s u b j e c t   t o   C e q q = 0 A e q q = b e q q L q q U
where q = vector of parameters to be optimized; C e q q = vector function of nonlinear equality constraints; Aeq, beq = matrix and vector of linear equality constraints, respectively; and qLqU = lower and upper limits.
Each component z(x) of the objective function S, considering x = ξL, within the interval [x0, xf] may be calculated as follows:
x 0 x f z x d x = 0 L z Q , L , ξ d ξ L = L 0 1 z ξ d ξ
The integral of Equation (62) can be solved numerically using an N-point Gaussian quadrature scheme, which provides high computational accuracy. That is,
0 1 z ξ d ξ k = 1 N w k z ξ ϑ k d e t J ϑ k
where wk = k-th point’s integration weight; ϑkk-th point’s value in the master-element coordinate system; J = Jacobian, k  [1, N]; and N = number of integration points.

4.2. Optimization Criteria

We assume that the criteria providing motion stability, smoothness, and safety are appropriate for composing the objective function. Note that the vehicle’s final positions in the longitudinal Srf and transverse Df directions relative to the reference are variable and depend on the maneuver destination (lane), the presence of obstacles, and speed distribution parameters.
The longitudinal speed deviation relative to a preset upper-level VζU may be the main “moving” factor of the AV model, owing to the quadratic form. The integral of the squared velocity deviation to the trajectory’s final point sf has the form
I V = 0 s f V ζ U V ζ 2 d s = 0 L V ζ U V ζ 2 s x d x = L 0 1 z V ξ d ξ
The integrand zV(ξ) is expressed through the nodal parameters Qv, Qc. Then,
z V ξ = V ζ U V ζ Q , L , ξ 2 s x Q c , L , ξ ,       z V = d i a g z V Q , L , ξ ϑ T
Considering the segment ξ ∈ [0, 1] is represented by the vector of increments Δξ, the final value can also be obtained as follows:
I V L 2 Δ ξ z V w
The longitudinal and lateral jerk criteria combine geometric and kinematic parameters. They reflect the character of transient dynamics in two directions. The longitudinal jerk is associated with the powertrain’s traction ability, while the lateral jerk is more closely related to steering control accuracy and stability. The approach is as follows:
I j p = 0 s f j p 2 d s = 0 L j p 2 s x d x = L 0 1 z j p ξ d ξ ,       p ζ , μ
The integrand zjp(ξ) is determined according to Equations (64)–(67) and depends on both Qv and Qc parameters; then, we obtain
z j p ξ = j p 2 Q , L , ξ s x Q c , L , ξ ,       z j p = d i a g z j p Q , L , ξ ϑ T
Then,
I j p L 2 Δ ξ z j p w
Motion time tf shows final time cost and may be estimated as follows:
I t = t f = 0 t f d t = 0 s f d s V = 0 L d x V x = L 0 1 d ξ V x L ξ = L 0 1 z t ξ d ξ
Discrete moments of time are determined using the same scheme as for lateral displacement by Equations (50)–(53). Thus,
Δ t i = x i 1 x i d x V x = L ξ i 1 ξ i d ξ V x i L ξ = L ξ i 1 ξ i z t i ξ d ξ ,       z t i ξ = 1 V x i Q , L , ξ
As a result, we obtain a vector of time intervals and the final time value
t = 0 i = 1 1 Δ t i i = 1 n Δ t i T ,       I t = t f = i = 1 n Δ t i
The final tangent angle αtf characterizes the vehicle’s stability control at the end of the maneuver. The desired value αd can be defined by the road reference’s tangent at the vehicle’s final position. Then,
I α = α t f α d 2
If a final angular position must strictly correspond to the reference’s tangent slope, then it is assumed that αd = αrf.
The final lateral displacement Df is assumed to best match the desirable lateral position Dd to satisfy the maneuver’s safety and completeness, and to control distances to marking lines. Then,
I D = D f D d 2
Particularly, Df may be assigned considering a half=width of the destination lane.
Since Srf and Df vary, they produce a series of possible final position Yf, which is the reference point for the final value yf provided by the trajectory integration procedure. Thus,
Y f = y r f + D f c o s α f ,       y t f Y f
Distances to moving obstacles. Since the distance between a moving obstacle and the AV changes continuously, the integral of the distance square between the AV and the i-th vehicle has the form
S d i = 0 t f d i 2 d t = 0 s f d i 2 d s V s = 0 L d i 2 d x V x x = L 0 1 d i 2 V x D ξ d ξ = L 0 1 z d i ξ d ξ
Using the schemes described above, it can be written
z d i ξ = d i 2 Q , L , ξ V x Q , L , ξ ,       z d i = d i a g z d i Q , L , ξ ϑ T ,       S d i L 2 Δ ξ z d i w
Due to separate planning for each maneuver variant, only vehicles detected by the AV sensory system within the maneuver’s boundaries are considered. Thus, the criterion is inversely proportional to the sum of integrals and grows with reducing distances
I d = i = 1 n 1 S d i
Cost Function S is represented by the sum of the weighted criteria indicated above. The condition for minimizing the objective function is as follows:
S = S q = W T I q = W T I m i n
where q = vector of the search-for parameters; I = vector of the integral criteria; and W = vector of weight factors. Thus,
W = W V W j ζ W j μ W t W α W D W d ,       I = I q = I V q I j ζ q I j μ q I t q I α q I D q I d q
where WV, W, W, Wt, Wα, WD, Wd = weight coefficients for quadratic deviations of the speed, longitudinal and lateral jerks, final time, final angular position, final lateral offset, and distances to obstacles, respectively.

4.3. Constraints

General approach. By restricting the vehicle’s motion to kinematic, dynamic, and physical parameters, it is possible to accelerate the optimization procedure. This narrows the search zone, followed by a decrease in the number of iterations. If the mentioned parameters are smooth functions, the equality constraints can be organized by integrating using the Gaussian scheme employed above. Suppose some parameter ψ varies within the upper ψU and lower ψL boundaries. Then, if a parameter does not exceed any limit, the area between boundaries ψU and ψL must equal a sum of areas above and below the ψ-function. That is, if a ψ-function is determined concerning the trajectory
0 s f ψ U ψ L d s = 0 s f ψ U ψ d s + 0 s f ψ ψ L d s
Changing the differential ds and integral limits, we obtain
L 0 1 ψ U ψ L s x d ξ = L 0 1 ψ U ψ s x d ξ + L 0 1 ψ ψ L s x d ξ
Denote for the first integral
z ψ U L ξ = ψ U ψ L s x ,       z ψ U L = d i a g z ψ U L ξ ϑ T ,       I ψ U L L 2 Δ ξ z ψ U L w
For the integral within the upper bound and ψ-function (Uf):
z ψ U f ξ = ψ U ψ s x ,       z ψ U f = d i a g z ψ U f ξ ϑ T ,       I ψ U f L 2 Δ ξ z ψ U f w
For the integral within the ψ-function and lower bound (fL):
z ψ f L ξ = ψ ψ L s x ,       z ψ f L = d i a g z ψ f L ξ ϑ T ,       I ψ f L L 2 Δ ξ z ψ f L w
The requirement of nonlinear equality constraint along the reference s is as follows:
c ψ = I ψ U L I ψ U f I ψ f L = 0
Kinematic constraints. We may restrict some kinematic parameters combined in a vector ψk. Then, introducing vectors of upper ψkU and lower ψkL limits, the vector ck of nonlinear integral constraints can be evaluated using the technique from Equations (81)–(86).
ψ k = V ζ ω ε j ζ ,       ψ k U = V ζ U ω U ε U j ζ U ,       ψ k L = V ζ L ω L ε L j ζ L ,       c k = c V ζ c ω c ε c j ζ
Physical constraints. The critical speed Vζs stipulated by the tire’s sideslip potential, may be used. Assuming all the wheels to be driving, the criterion is expressed as follows:
V ζ s = g φ μ cos β / K
where g = gravity acceleration constant, φμ = lateral friction coefficient.
If the current total friction in longitudinal direction is φζ and the maximum friction potential corresponds to φmax, the immediate lateral limit is
φ μ = φ m a x 1 φ ζ / φ m a x 2
where
φ ζ = a ζ / g + f d + f r
where fr = coefficient of total rolling resistance, and fd = specific drag force.
Since Vζs may vary between a minimum value Vζsmin and infinity, the maximum allowable speed should be less. To satisfy this requirement, a rapidly saturating function like χ(·) = tanh(·) may be used. Then, the integral condition is as follows
0 t f χ V ζ s d t = 0 t f χ V ζ s χ V ζ d t + 0 t f χ V ζ d t
Using Equations (81)–(86), physical restrictions on the AV’s speed may be imposed. Then,
ψ p = V ζ ,       ψ p U = V ζ s ,       ψ k L = 0 ,       c p = c V ζ
To control the vehicle’s traction potential, the acceleration must be restricted according to the speed-acceleration characteristic. Then, the following condition must be satisfied:
V ζ m i n V ζ m a x a ζ U a ζ L d V ζ = V ζ m i n V ζ m a x a ζ U a ζ d V ζ + V ζ m i n V ζ m a x a ζ a ζ L d V ζ
where aζU, aζL = upper and lower acceleration limits achievable by the vehicle.
The general scheme for obtaining the integrals is like Equations (81)–(85). Then, the dynamic constraint is denoted as follows:
ψ d = a ζ ,       ψ d U = a ζ U ,       ψ d L = a ζ L ,       c d = c a ζ
Boundary constraints determine the boundary conditions for kinematic parameters. Since the initial (0) values are known or may be directly evaluated, one may require (but not necessarily) that the predicted final (f) values of position ytf, acceleration aζf, and jerk jζf correspond to desirable values Yf, Aζf, and Jζf. That is,
ψ b = y t f a ζ f j ζ f ,       ψ b f = Y f A ζ f J ζ f ,       c b = ψ b ψ b f = 0
Complete Set of Constraints. Combining all the parameters defined in the kinematic, physical, dynamic, and boundary constraints, the full sets of parameters, limits, and nonlinear constraints are as follows:
ψ = ψ k ψ p ψ d ψ b ,       ψ U = ψ k U ψ p U ψ d U ψ b 0 ,       ψ L = ψ k L ψ p L ψ d L ψ b f ,       c e q = c k c p c d c b
Initial conditions. It is supposed that the nodal parameters from the previous cycle are known. Thus, they are automatically included in the initial conditions for the next section of planning. If the nodal parameters are unknown, qc0 and qv0 must be determined proceeding from the instantaneous geometric characteristics. Thus, curvature-based parameters may be found as follows:
H 0 = s i n α 0 ,       β 0 = α 0 ϕ 0 ,       K 0 = sin β 0 b ,       K 0 = 1 R r 0 D 0 = K r 0 1 D 0 K r 0
where D0 = initial transverse position, Kr0 = initial curvature of the reference line (midline).
Supposing D to be constant at the beginning of the maneuver, the first, second, and third curvature derivatives may be determined. Thus,
d K d x 0 = d d x K r 0 1 D 0 K r 0 = d K r d x 0 / 1 D 0 K r 0 2
d 2 K d x 2 0 = d d x d K r d x 0 1 D 0 K r 0 2 = 1 D 0 K r 0 d 2 K r d x 2 0 + 2 D 0 d K r d x 0 2 1 D 0 K r 0 3
d 3 K d x 3 0 = d d x 1 D 0 K r 0 d 2 K r d x 2 0 + 2 D 0 d K r d x 0 2 1 D 0 K r 0 3 =
= d 3 K r d x 3 0 1 D 0 K r 0 2 + 6 D 0 d K r d x 0 d 2 K r d x 2 0 1 D 0 K r 0 + 6 D 0 2 d K r d x 0 3 1 D 0 K r 0 4
Similarly, the values of the kinematic parameters are defined. The initial speed is Vζ0. For the first derivative, considering Equations (7)–(9), then
d V ζ d x 0 = 1 V x 0 d V ζ d t 0
where
V x 0 = V ζ 0 cos α 0 cos β 0 ,       ω 0 = d α d x 0 + d β d x 0 V x 0 ,       V μ 0 = V ζ 0 tan β 0 ,
a ζ 0 = d V ζ d t 0 ω 0 V μ 0 ,       d V ζ d t 0 = a ζ 0 + ω 0 V μ 0
For the second derivative, considering Equations (11)–(16), then
d 2 V ζ d x 2 0 = 1 V x 0 2 d 2 V ζ d t 2 0 1 V x 0 d V ζ d x 0 d V x d x 0
where
d 2 V ζ d t 2 0 = j ζ 0 + 2 d V μ d t 0 + V ζ 0 ω 0 ω 0 + ε 0 V μ 0 ,       V μ 0 = V ζ 0 tan β 0 ,
d V μ d t 0 = d V μ d x 0 V x 0 ,       d V μ d x 0 = d V ζ d x 0 tan β 0 + V ζ 0 d β dx 0 sec 2 β 0
For the third derivative, considering Equations (11)–(17), then
d 3 V ζ d x 3 0 = d d t d 2 V ζ 0 d t 2 3 d 2 V ζ 0 d x 2 d V x 0 d x V x 0 2 d V ζ 0 d x d 2 V x 0 d x 2 V x 0 2 + d V x 0 d x 2 V x 0 / V x 0 3
where
d 2 V μ d x 2 0 = d 2 V ζ 0 d x 2 tan β 0 + V ζ d 2 β 0 d x 2 + 2 d β 0 d x d V ζ 0 d x + V μ 0 d β 0 d x sec 2 β 0
Other components were found by differentiating the kinematic relations from the preceding equations.

5. Simulation

The MATLAB environment [31] was used to compose the software and execute virtual tests. The optimization procedures were based on the built-in fmincon function, which allows SQP algorithm and nonlinear constraints. The numerical integration is performed using the five-point Gaussian quadrature scheme, with a relative step size of Δξ = 0.1. To model the AV, we used Audi A4 technical data [32].
The initial values (0) and constraints (upper U and lower L) are defined as follows:
Speed
V ζ 0 = 60   k m h ,       V ζ U = 80   k m h ,       V ζ L = 50   k m h
Acceleration
a ζ U = g φ m a x   m s 2 ,     a ζ L = 0.5   m s 2 ,     a ζ 0 = a ζ f = 0   m s 2 ,     a ζ l i m = a ζ l i m V ζ
where aζlim is the function of the vehicle throttle response characteristic.
Jerk
j ζ U = 13   m s 3 ,       j ζ L = 6.5   m s 3 ,       j ζ f = 0   m s 3
Yaw rate
ω U = 0.5   r a d s ,       ω L = 0.5   r a d s
Angular acceleration
ε U = 3   r a d s 2 ,       ε L = 3   r a d s 2
Based on a series of virtual tests, we assigned a set of weight coefficients W from Equation (80) as follows:
W = 7 5 0.1 0 2 1 1 T
Here, we focus on the speed factor (the first value) and the softness of the longitudinal jerk (the second value). The transverse jerk (the third value) contradicts the speed factor and, therefore, the value is small. The time factor (the fourth value) has a relatively low sensitivity, consequently, it can be neglected. The angular position at the maneuver’s end (the fifth value) is extremely important for maintaining directional stability. The factor of approaching other vehicles (the sixth value) should not significantly distort the trajectory with a minimum curvature intensity. The factor of safe distance (the seventh value) at the maneuver’s end is partially involved into the previous parameter and, thus, is assigned relatively small.
Experiment 1.
The AV is supposed to move along a curved section of a three-lane highway under conditions of good friction with coefficient φmax = 0.85. Hypothetically, the maneuver may be organized with many variants of final lateral displacement Df within the road boundaries. Thus, we shall build three prognoses for the lane change maneuver with lateral displacement Df in the vicinities of the lanes’ midlines. There will be four moving obstacles indexed as vi, i ∈ [1, 2, …, 4]. Herein, index 0 means the initial position, and index f implies the final position. The initial speeds of impeding vehicles are, respectively, Vi0 = (45, 50, 50, 60) km/h.
Figure 5 depicts trajectory variants and positions of the impeding vehicles (initial and final) assuming they keep moving on the same lanes. As shown, the optimization setting corresponds to a more aggressive drive style, utilizing less needed space. At the same time, Trajectories 1 and 3 have a section (about 10 m) of smooth entry into the maneuvers, given the close location of vehicles 1 and 3. In turn, the maneuver on lane 2 required minimal action and distance to correct the vehicle’s position and to center it relative to the midline.
Figure 6 depicts the results of forecasting speeds and accelerations relative to restrictions. In the maneuver to lane 1, the main bend occurs in the trajectory’s middle, and in the maneuver to lane 3, in the final part. This explains the critical speed curves’ locations (Figure 6a). Since the final longitudinal acceleration (Figure 6b), according to the conditions of Equation (95), should be equal to zero, the intensity of the growing the speed decreases toward the final point. Thus, the maneuver to lane 1 is shorter but at a higher speed than the maneuver to lane 3, where the maneuver base’s length is also influenced by the distance to vehicle 3, which is following behind. The maneuver on lane 2 does not give time for increasing the speed because the planned trajectory quickly merges with the midline. The nature of lateral acceleration’s change (Figure 6c) is stipulated by the required trajectory’s curvature in form, and it is limited in amplitude by the permissible maximum total acceleration amax (Figure 6d) under a given condition of tire–road friction.
Figure 7 depicts the kinematic and geometric parameters associated with constraints. Longitudinal jerk is one of the basic optimization criteria, indicating that the parameter is smooth, unambiguous, and strictly within preset limits (Figure 7a). The yaw rate (Figure 7b) characterizes the trajectory’s curvature and is uniformly distributed within a segment. Angular acceleration (Figure 7c) has practical importance as it enables the redistribution of traction forces between the wheels to stabilize the vehicle. The graph of distances between vehicles (Figure 7a) shows that safe spaces are maintained throughout the entire movement, with the initial small value primarily determined by the lateral component. Figure 8 illustrates the geometric parameters of the trajectories of the maneuvers. All the curvatures and their derivatives are smooth and stable.
Experiment 2.
As the second case, we consider a variant with worsened friction conditions, accepting φmax = 0.5 (Figure 9). To ensure the AV’s lateral stability, a gentler curvature is needed. This causes the required path s to be closer to the upper limit of the reference sr variable length.
The trajectories differ in the curvature phases. The first maneuver requires a larger curvature at its beginning and a minimum in the second phase. The second-lane maneuver is based on the necessary space for a smooth transition in curvature until the lane’s midline is reached. Unlike the first variant, the exit to the third lane initially features a small curvature and gradually increases it towards completing the maneuver.
Figure 10 depicts the forecasting results of kinematic parameters under the condition of reduced tire–road friction. As shown, the critical speeds (Figure 10a) for the corresponding maneuvers occur at points of concentrated curvature. Nevertheless, the vehicle can change the speed mode by accelerating (Figure 10b) on relatively straight sections. The nature of the change in lateral acceleration (Figure 10c) is smooth and does not imply that the total acceleration (Figure 10d) goes beyond the limits determined by the friction potential.
Figure 11 depicts the kinematic parameters used with hard constraints. As seen, all curves are smooth, and their extremum values lie within the preset limits. Distances to moving obstacles (Figure 11d) are maintained safely. Figure 12 illustrates the geometric parameters of the trajectories. As seen in Figure 12a, the curvature is distributed smoothly and uniformly, and the average angle of steered wheels (Figure 12d) practically copies the curvature. The curvature intensity (Figure 12b) and its second derivative (Figure 12c) for the maneuver on the second lane are characterized by an increase in the final phase due to the smallness of the gap required for the trajectory to merge with the lane midline.

6. Conclusions

This study has developed a motion planning technique that simultaneously optimizes both trajectory and speed using a reverse technique. The proposed approach focuses on modeling derivatives rather than direct parameters, demonstrating its effectiveness in achieving the desired outcomes. It is important to note that the AV was assumed to be all-wheel-drive to account for the critical speed limitations of the entire vehicle. Additionally, the minimum trajectory length must exceed the distance required for emergency stopping. Based on this study, the following highlights underscore the effectiveness of the proposed technique:
  • Employing an inverse approach to predict AV motion references has demonstrated several advantages, including high efficiency, relatively low computational costs, and a reduced number of varying unknowns. This method is expected to yield better quality and performance compared with directly modeling trajectories using polynomials. The inverse approach achieves a better alignment between trajectory and speed models, offering greater flexibility in curvature than the polynomial model approach.
  • Several key findings should be noted. First, because the method utilizes the derivatives of modeling parameters, followed by numerical integration, rather than simulating trajectories and speeds directly, it produces simple and smooth reference curves. All kinematic parameters, including jerks, ensure smoothness, clarity, and continuity between road segments. Second, the proposed technique requires a minimal number of varying parameters. While the cost function encompasses multiple optimization criteria, priority should be given to the accuracy of lateral displacement D and to ensuring motion safety in relation to other traffic participants. Finally, using nonlinear equality constraints, represented by integral numerical techniques, enhances prediction reliability compared with linear equality constraints, with minimal impact on optimization performance.
  • The vehicle’s position and lane width were established prior to planning the motion, allowing for the generation of several trajectory variants with different lateral displacements (D). In this study, we focused on a minor deviation from the lane’s midline, resulting in the modeling of three maneuver variants. The criteria for selecting the best trajectory may include factors such as minimum transition time, maximum final speed, longest trajectory, minimum control cost, or a combination of these. However, this study did not address the selection of the most effective maneuver, as that topic is reserved for future research.
  • All simulations were conducted on a laptop equipped with an 11th Gen Intel® Core™ i7-1185G7 processor (Santa Clara, CA, USA) running at 3.00 GHz (base frequency: 1.80 GHz) and 16.0 GB of RAM, using a 64-bit version of Windows 10 Pro. The software environment utilized was MATLAB R2023b (The MathWorks, Natick, MA, USA), which provided the basic optimization function fmincon. On average, the computation time for one maneuver prognosis ranged from approximately 0.5 to 2.4 s, depending on the optimization settings, desired accuracy, and initial conditions.
  • This study addresses a significant gap between theoretical models, such as action-based planners, and practical applications, making it applicable to both urban and highway AV systems. By bridging the integration gap between trajectory planning and speed management, the approach promotes more predictable, comfortable, and physically feasible autonomous motion. As AVs transition from controlled highway environments to complex urban settings, the proposed method—aligning dynamic constraints with real-time performance—is crucial in ensuring safe and passenger-friendly deployment. The inverse technique presented in this paper could establish a foundational tool for the next generation of motion planners.
  • While this study advances motion planning with its inverse derivative-based approach, several limitations remain. The method assumes idealized conditions—perfect state estimation, all-wheel-drive dynamics, and simplified circular obstacles—which may degrade performance in real-world noisy environments or with heterogeneous vehicle platforms. Computational efficiency, though improved, could struggle with ultra-long horizons or dense urban scenarios, and the lack of hardware validation leaves open questions about real-world robustness. Future research should prioritize real-time enhancements (e.g., GPU acceleration), robust perception integration (e.g., sensor fusion for dynamic obstacle prediction), and experimental validation (e.g., on-road testing). Extending the framework to multi-agent coordination (e.g., V2X-enabled planning) could further broaden its impact. Addressing these gaps would bridge the divide between theoretical smoothness and deployable autonomy, making the method viable for safety-critical applications. Furthermore, future research should compare the proposed approach with other approaches in the literature using various criteria, including computation speed.

Author Contributions

Conceptualization, M.D. and S.M.E.; methodology, M.D.; software, M.D.; validation, M.D. and S.M.E.; formal analysis, S.M.E.; investigation, M.D.; resources, S.M.E.; data curation, M.D.; writing—original draft preparation, S.M.E. and M.D.; writing—review and editing, S.M.E.; visualization, M.D.; supervision, S.M.E.; project administration, S.M.E.; funding acquisition, S.M.E. All authors have read and agreed to the published version of the manuscript.

Funding

This research is financially supported by the Natural Sciences and Engineering Research Council of Canada (grant No. RGPIN-2020-04667).

Institutional Review Board Statement

No institutional review is required.

Informed Consent Statement

Not applicable.

Data Availability Statement

Some or all data, models, or codes that support the findings of this study are available from the corresponding author upon reasonable request.

Conflicts of Interest

The authors declare no conflicts of interest.

References

  1. Xia, T.; Chen, H. A Survey of Autonomous Vehicle Behaviors: Trajectory Planning Algorithms, Sensed Collision Risks, and User Expectations. Sensors 2024, 24, 4808. [Google Scholar] [CrossRef]
  2. Zhang, Y.; Chen, H.; Waslander, S.; Gong, J.; Xiong, G.; Yang, T.; Liu, K. Hybrid Trajectory Planning for Autonomous Driving in Highly Constrained Environments. IEEE Access 2018, 6, 32800–32819. [Google Scholar] [CrossRef]
  3. Jiang, Y.; Jin, X.; Xiong, Y.; Liu, Z. A Dynamic Motion Planning Framework for Autonomous Driving in Urban Environments. In Proceedings of the 2020 39th Chinese Control Conference, Shenyang, China, 27–29 July 2020; pp. 5429–5435. [Google Scholar] [CrossRef]
  4. Dang, D.; Gao, F.; Hu, Q. Motion Planning for Autonomous Vehicles Considering Longitudinal and Lateral Dynamics Coupling. Appl. Sci. 2020, 10, 3180. [Google Scholar] [CrossRef]
  5. Li, G.; Zhang, X.; Guo, H.; Lenzo, B.; Guo, N. Real-Time Optimal Trajectory Planning for Autonomous Driving with Collision Avoidance Using Convex Optimization. Automot. Innov. 2023, 6, 481–491. [Google Scholar] [CrossRef]
  6. Tang, X.; Li, B.; Du, H. A Study on Dynamic Motion Planning for Autonomous Vehicles Based on Nonlinear Vehicle Model. Sensors 2023, 23, 443. [Google Scholar] [CrossRef]
  7. Liniger, A.; Gool, L. Safe Motion Planning for Autonomous Driving using an Adversarial Road Model. arXiv 2020. [Google Scholar] [CrossRef]
  8. Yang, W.; Li, C.; Zhou, Y. A Path Planning Method for Autonomous Vehicles Based on Risk Assessment. World Electr. Veh. J. 2022, 13, 234. [Google Scholar] [CrossRef]
  9. Hu, Z.; Yang, Z.; Liu, X.; Zhang, W. Radar-based path planning of autonomous surface vehicle with static and dynamic obstacles in a Frenet Frame. J. Navig. 2023, 76, 487–505. [Google Scholar] [CrossRef]
  10. Jin, X.; Li, Z.; Ikiela, N.V.O.; He, X.; Wang, Z.; Tao, Y.; Lv, H. An Efficient Trajectory Planning Approach for Autonomous Ground Vehicles Using Improved Artificial Potential Field. Symmetry 2024, 16, 106. [Google Scholar] [CrossRef]
  11. Dong, D.; Ye, H.; Luo, W.; Wen, J.; Huang, D. Collision Avoidance Path Planning and Tracking Control for Autonomous Vehicles Based on Model Predictive Control. Sensors 2024, 24, 5211. [Google Scholar] [CrossRef]
  12. Jeng, S.-L.; Chieng, W.-H.; Wang, Y.-C. Real-Time Heuristic Motion Planning for Autonomous Vehicle Driving. J. Soc. Mech. Eng. 2021, 42, 187–196. [Google Scholar] [CrossRef]
  13. Lu, Y.; He, S.; Li, Y.; Wu, Y.; Zhong, W. A real-time decoupling trajectory planning method for on-road autonomous driving. IET Control. Theory Appl. 2022, 17, 1800–1812. [Google Scholar] [CrossRef]
  14. Cheng, J.; Chen, Y.; Zhang, Q.; Gan, L.; Liu, M. Real-Time Trajectory Planning for Autonomous Driving with Gaussian Process and Incremental Refinement. In Proceedings of the 2022 International Conference on Robotics and Automation (ICRA), Philadelphia, PA, USA, 23–27 May 2022; pp. 8999–9005. [Google Scholar]
  15. Jiang, Y.; Liu, Z.; Qian, D.; Zuo, H.; He, W.; Wang, J. Robust Online Path Planning for Autonomous Vehicle Using Sequential Quadratic Programming. In Proceedings of the IEEE Intelligent Vehicles Symposium (IV), Aachen, Germany, 5–9 June 2022; pp. 175–182. [Google Scholar] [CrossRef]
  16. 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]
  17. Scheffe, P.; Henneken, T.M.; Kloock, M.; Alrifaee, B. Sequential Convex Programming Methods for Real-Time Optimal Trajectory Planning in Autonomous Vehicle Racing. IEEE Trans. Intell. Veh. 2022, 8, 661–672. [Google Scholar] [CrossRef]
  18. Diachuk, M.; Easa, S.M. Path and control planning for autonomous vehicles in restricted space and low speed. J. Infrastruct. 2020, 5, 42. [Google Scholar] [CrossRef]
  19. Pérez-Dattari, R.; Brito, B.; de Groot, O.; Kober, J.; Alonso-Mora, J. Visually-guided motion planning for autonomous driving from interactive demonstrations. Eng. Appl. Artif. Intell. 2022, 116, 105277. [Google Scholar] [CrossRef]
  20. Diachuk, M.; Easa, S.M. Improved mathematical approach for modeling sport differential mechanism. Vehicles 2022, 4, 1122–1157. [Google Scholar] [CrossRef]
  21. Diachuk, M.; Easa, S.M. Modeling combined operation of engine and torque converter for improved vehicle powertrain’s complex. Vehicles 2022, 4, 433–444. [Google Scholar] [CrossRef]
  22. Diachuk, M.; Easa, S.M. Improved models of vehicle differential mechanisms using various approaches. Int. J. Veh. Syst. Model. Test. 2023, 17, 210–230. [Google Scholar] [CrossRef]
  23. Diachuk, M.; Easa, S.M. Motion planning for autonomous vehicles using sequential optimization. Vehicles 2022, 4, 808–824. [Google Scholar] [CrossRef]
  24. Diachuk, M.; Easa, S.M. Using inverse dynamics technique in planning autonomous vehicle speed mode considering physical constraints. Highlights Veh. 2023, 1, 29–53. [Google Scholar] [CrossRef]
  25. Dorpmüller, P.; Schmitz, T.; Bejagam, N.; Bertram, T. Time-Optimal Trajectory Planning in Highway Scenarios Using Basis-Spline Parameterization. In Proceedings of the IEEE 26th International Conference on Intelligent Transportation Systems (ITSC), Bilbao, Spain, 24–28 September 2023; pp. 596–601. [Google Scholar] [CrossRef]
  26. Wang, Y.; Lin, Z. Research on path planning for autonomous vehicle based on Frenet system. J. Eng. Res. 2023, 11, 100080. [Google Scholar] [CrossRef]
  27. Trauth, R.; Moller, K.; Würsching, G.; Betz, J. FRENETIX: A High-Performance and Modular Motion Planning Framework for Autonomous Driving. IEEE Access 2024, 12, 127426–127439. [Google Scholar] [CrossRef]
  28. Huang, H.; Liu, Y.; Liu, J.; Yang, Q.; Wang, J.; Abbink, D.; Zgonnikov, A. General Optimal Trajectory Planning: Enabling Autonomous Vehicles with the Principle of Least Action. Engineering 2023, 33, 63–76. [Google Scholar] [CrossRef]
  29. Diachuk, M.; Easa, S.M. Planning speed mode of all-wheel drive autonomous vehicles considering complete constraint set. Vehicles 2024, 6, 191–230. [Google Scholar] [CrossRef]
  30. Diachuk, M.; Easa, S.M. Simultaneous trajectory and speed planning for autonomous vehicles considering maneuver variants. Appl. Sci. 2024, 14, 1579. [Google Scholar] [CrossRef]
  31. MATLAB R2022b. 2023. Available online: https://www.mathworks.com/ (accessed on 22 January 2023).
  32. Audi A4 Quatro Characteristics. 2023. Available online: http://www.automobile-catalog.com/car/2011/1187660/audi_a4_3_2_fsi_quattro_attraction_tiptronic.html (accessed on 19 January 2023).
Figure 1. Study methodology.
Figure 1. Study methodology.
Wevj 16 00272 g001
Figure 2. Scheme of the ideal vehicle kinematics model.
Figure 2. Scheme of the ideal vehicle kinematics model.
Wevj 16 00272 g002
Figure 3. Basic geometric parameters: (a) Scheme of forming AV trajectory using Frenet coordinates. (b) Trajectory variants and distances to moving obstacles.
Figure 3. Basic geometric parameters: (a) Scheme of forming AV trajectory using Frenet coordinates. (b) Trajectory variants and distances to moving obstacles.
Wevj 16 00272 g003
Figure 4. Scheme of numerical integration at specified points.
Figure 4. Scheme of numerical integration at specified points.
Wevj 16 00272 g004
Figure 5. Prediction of lane-change trajectories with friction factor φmax = 0.85.
Figure 5. Prediction of lane-change trajectories with friction factor φmax = 0.85.
Wevj 16 00272 g005
Figure 6. Results of forecasting speeds and accelerations for maneuvers at friction factor φmax = 0.85: (a) longitudinal and critical (sideslip) speeds, (b) longitudinal accelerations, (c) lateral accelerations, and (d) total accelerations.
Figure 6. Results of forecasting speeds and accelerations for maneuvers at friction factor φmax = 0.85: (a) longitudinal and critical (sideslip) speeds, (b) longitudinal accelerations, (c) lateral accelerations, and (d) total accelerations.
Wevj 16 00272 g006
Figure 7. Results of forecasting kinematic parameters of maneuvers at φmax = 0.85: (a) longitudinal jerk, (b) yaw rate, (c) angular acceleration, and (d) distance to obstacles.
Figure 7. Results of forecasting kinematic parameters of maneuvers at φmax = 0.85: (a) longitudinal jerk, (b) yaw rate, (c) angular acceleration, and (d) distance to obstacles.
Wevj 16 00272 g007
Figure 8. Results of geometric indicators for forecasting lane maneuvers at φmax = 0.85: (a) curvature, (b) curvature’s first derivative, (c) curvature’s second derivative, and (d) steering angle.
Figure 8. Results of geometric indicators for forecasting lane maneuvers at φmax = 0.85: (a) curvature, (b) curvature’s first derivative, (c) curvature’s second derivative, and (d) steering angle.
Wevj 16 00272 g008
Figure 9. Prediction of lane-change trajectories under the condition φmax = 0.5.
Figure 9. Prediction of lane-change trajectories under the condition φmax = 0.5.
Wevj 16 00272 g009
Figure 10. Results of forecasting speeds and accelerations for maneuvers at friction factor φmax = 0.5: (a) longitudinal and critical (sideslip) speeds, (b) longitudinal accelerations, (c) lateral accelerations, and (d) total accelerations.
Figure 10. Results of forecasting speeds and accelerations for maneuvers at friction factor φmax = 0.5: (a) longitudinal and critical (sideslip) speeds, (b) longitudinal accelerations, (c) lateral accelerations, and (d) total accelerations.
Wevj 16 00272 g010
Figure 11. Results of forecasting kinematic parameters of maneuvers at φmax = 0.5: (a) longitudinal jerk, (b) yaw rate, (c) angular acceleration, and (d) distance to obstacles.
Figure 11. Results of forecasting kinematic parameters of maneuvers at φmax = 0.5: (a) longitudinal jerk, (b) yaw rate, (c) angular acceleration, and (d) distance to obstacles.
Wevj 16 00272 g011
Figure 12. Results of geometric indicators for forecasting lane maneuvers at φmax = 0.5: (a) curvature, (b) curvature’s first derivative, (c) curvature’s second derivative, (d) steering angle.
Figure 12. Results of geometric indicators for forecasting lane maneuvers at φmax = 0.5: (a) curvature, (b) curvature’s first derivative, (c) curvature’s second derivative, (d) steering angle.
Wevj 16 00272 g012
Table 1. Comparison of Autonomous Vehicle Motion Planning Literature a.
Table 1. Comparison of Autonomous Vehicle Motion Planning Literature a.
CategoryReference (Date)Study FocusMethodologyContextStrengthsLimitations
Dynamic Motion PlanningJiang et al. [3] (2020)Urban motion planning frameworkDynamic optimizationIntersections, urbanEffective in complex environmentsLimited to low-speed scenarios
Dang et al. [4] (2020)Motion planning with coupled dynamicsNonlinear MPC with coupled lateral–longitudinal modelHigh-speed highwaysBetter normal driving performanceHigh computational complexity. Simplified obstacle avoidance
Li et al. [5] (2022)Cartesian-based planning (non-Frenet)CC, dynamic constraintsRural winding roadsAvoids Frenet frame distortionsLess efficient in structured roads
Tang et al. [6] (2023)Nonlinear vehicle dynamics for motion planningNonlinear MPC, dynamic constraints, T-S fuzzy model Urban highwaysHigh-fidelity vehicle dynamics modelingComputationally intensive
Obstacle AvoidanceLiniger and Gool [7] (2020)Adversarial road model for safetyGame theory and H-J = reachabilityHighways, multi-vehiclesEnables cooperative planningRequires V2V infrastructure
Yang et al. [8] (2022)Risk-based path planningRisk model, graph search, APFMixed traffic (urban)Explicit risk quantificationConservative dynamic scenarios
Hu et al. [9] (2023)Radar-based path planning Frenet frame optimizationMaritime (harbors)Effective marine navigationLimited to aquatic environments
Jin et al. [10] (2024)Improved artificial potential fieldAPF with local minima avoidanceOff-road, restricted spaceSmooth collision avoidanceProne to local minima
Dong et al. [11] (2024)MPC-based collision avoidanceNonlinear MPC, safety constraintsIntersections, urbanRobust collision avoidanceHigh computational load
Real-Time PlanningJeng et al. [12] (2021)Heuristic motion planningRule-based heuristic approachCampusesFast computationLess optimal
Lu et al. [13] (2022)Real-time decoupled trajectory planningDecoupling method, MPCHighways (trucks)Fast computation, handles uncertaintySimplified dynamics
Cheng et al. [14] (2022)Real-time planning GP, incremental refinementPedestrian zonesBalances accuracy and efficiencySensitive to sensor noise
Jiang et al. [15] (2022)Robust online path planningSQOConstruction sitesHandles uncertaintiesHigh computational load
Li et al. [16] (2023)Real-time optimal planningCO, collision avoidanceTight spaces, urbanGuarantees safetyRequires convex constraints
Scheffe et al. [17] (2023)Real-time trajectory planning for racingSequential CORace trucksHandles aggressive maneuversSpecialized for racing contexts
Modeling and ControlDiachuk and Easa [18] (2020)Low-speed path planningConstrained optimizationParking/warehousesEffective tight spacesLimited to low-speed scenarios
Pérez-Dattari et al. [19] (2022)Visually guided planning Interactive learningParking lotsIncorporates human-like planningRequires extensive training data
Diachuk and Easa [20] (2022)Powertrain modeling for improved vehicle dynamicsInverse dynamics, powertrain modelingOff-road (4 × 4 vehicles)Integrates vehicle mechanicsRequires detailed powertrain data
Diachuk and Easa [21,22,23,24] (2023)Speed planning considering physical constraintsInverse dynamics techniqueAutonomous vehiclesRealistic speed profilesRequires precise vehicle dynamics model
Trajectory OptimizationDorpmüller et al. [25] (2023)Time-optimal trajectory planningB-spline parameterizationHighway (lane change)Time-efficient smooth trajectoriesAssumes ideal vehicle dynamics
Wang and Lin [26] (2023)Frenet-based path planningFrenet coordinate systemHighway, mergingSimplifies path representationOver-reliance on reference line
Trauth et al. [27] (2024)Modular motion planning frameworkFrenet-based planningHighways, urbanHigh flexibility, real-time performanceComplex implementation
Huang et al. [28] (2024)Least-action principle for optimal trajectoriesVariational optimization, physics-inspiredGeneral roadsGeneralizable frameworkHigh computational complexity
Diachuk and Easa [29] (2024)Simultaneous trajectory–speed planningInverse dynamics, GQ, SO Highways (AWD)Comprehensive constraint handlingIncreased computational load
Present Study (2025)Simultaneous trajectory-speed planning, optimizing kinematic parameters for smoothness/continuity.Inverse numerical integration with GQ, SQO with nonlinear constraints.Highway, urban environmentsEnsures jerk continuity, handles kinematic/dynamic constraints. Considers LC and moving obstacles.Computationally heavy (0.5–2.4 s/maneuver)
a AWD = all-wheel drive, CC = Cartesian coordinates, CO = Convex optimization, GP = Gaussian process, GQ = Gaussian quadrature, H-J = Hamilton–Jacobi, LC = lane change, MPC = model predictive control, SQO = sequential quadratic optimization, SO = sequential optimization, T-S = Takagi–Sugeno, and V2V = vehicle-to-vehicle.
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

Easa, S.M.; Diachuk, M. Inverse Dynamics-Based Motion Planning for Autonomous Vehicles: Simultaneous Trajectory and Speed Optimization with Kinematic Continuity. World Electr. Veh. J. 2025, 16, 272. https://doi.org/10.3390/wevj16050272

AMA Style

Easa SM, Diachuk M. Inverse Dynamics-Based Motion Planning for Autonomous Vehicles: Simultaneous Trajectory and Speed Optimization with Kinematic Continuity. World Electric Vehicle Journal. 2025; 16(5):272. https://doi.org/10.3390/wevj16050272

Chicago/Turabian Style

Easa, Said M., and Maksym Diachuk. 2025. "Inverse Dynamics-Based Motion Planning for Autonomous Vehicles: Simultaneous Trajectory and Speed Optimization with Kinematic Continuity" World Electric Vehicle Journal 16, no. 5: 272. https://doi.org/10.3390/wevj16050272

APA Style

Easa, S. M., & Diachuk, M. (2025). Inverse Dynamics-Based Motion Planning for Autonomous Vehicles: Simultaneous Trajectory and Speed Optimization with Kinematic Continuity. World Electric Vehicle Journal, 16(5), 272. https://doi.org/10.3390/wevj16050272

Article Metrics

Back to TopTop