Next Article in Journal
U-ResNet, a Novel Network Fusion Method for Image Classification and Segmentation
Previous Article in Journal
FM-Net: A New Method for Detecting Smoke and Flames
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Fast Path Planning for Kinematic Smoothing of Robotic Manipulator Motion

School of Electrical and Information Engineering, Jiangsu University, Zhenjiang 212013, China
*
Author to whom correspondence should be addressed.
Sensors 2025, 25(17), 5598; https://doi.org/10.3390/s25175598
Submission received: 4 August 2025 / Revised: 2 September 2025 / Accepted: 3 September 2025 / Published: 8 September 2025
(This article belongs to the Section Sensors and Robotics)

Abstract

The Rapidly-exploring Random Tree Star (RRT*) algorithm is widely applied in robotic manipulator path planning, yet it does not directly consider motion control, where abrupt changes may cause shocks and vibrations, reducing accuracy and stability. To overcome this limitation, this paper proposes the Kinematically Smoothed, dynamically Biased Bidirectional Potential-guided RRT* (KSBB-P-RRT*) algorithm, which unifies path planning and motion control and introduces three main innovations. First, a fast path search strategy on the basis of Bi-RRT* integrates adaptive sampling and steering to accelerate exploration and improve efficiency. Second, a triangle-inequality-based optimization reduces redundant waypoints and lowers path cost. Third, a kinematically constrained smoothing strategy adapts a Jerk-Continuous S-Curve scheme to generate smooth and executable trajectories, thereby integrating path planning with motion control. Simulations in four environments show that KSBB-P-RRT* achieves at least 30% reduction in planning time and at least 3% reduction in path cost, while also requiring fewer iterations compared with Bi-RRT*, confirming its effectiveness and suitability for complex and precision-demanding applications such as agricultural robotics.

1. Introduction

Path planning [1,2] and motion control [3,4] are widely recognized as the two fundamental components of autonomous robotic manipulator systems, forming the basis for safe, stable, and precise task execution. With the continuous progress of intelligent robotics, application scenarios have become increasingly complex and diversified [5,6], placing higher demands on both planning efficiency and control robustness. Among these, agricultural environments represent a particularly challenging domain due to their dynamic, unstructured, and highly variable operating conditions [7,8]. These challenges underscore the critical importance of effective path planning and reliable motion control as prerequisites for achieving accurate and efficient manipulator performance in real-world applications.
Path planning is responsible for generating collision-free trajectories from an initial to a goal position [9], with its benefits clearly demonstrated in agricultural applications. Guan [10] reported that an optimized planner increased the picking success rate to 90%. For orchard harvesting, Liu [11] showed that an advanced planning approach improved harvesting efficiency and reduced task execution time in cluttered environments. Likewise, in a dual-arm fruit-harvesting system, Yoshida [12] demonstrated that an enhanced planner improved operational stability and reliability during harvesting operations, supporting its applicability under real field conditions.
These practical outcomes are underpinned by advances in robotic path planning algorithms, which are based on obstacle-avoidance requirements [13], such as Dijkstra’s algorithm [14], the A* algorithm [15], and the Rapidly-exploring Random Tree (RRT) algorithm [16]. Compared to graph-based algorithms like Dijkstra’s and A*, the RRT algorithm offers more efficient exploration of the configuration space and better adaptability to high-dimensional planning problems, which has led to its widespread application in robotic manipulator path planning. However, the standard RRT algorithm exhibits notable limitations, such as low path quality and slow planning speed, which hinder its ability to meet the stringent demands of real-time performance and robustness in complex environments. To address these limitations, various improved approaches have been proposed to enhance the performance of the RRT algorithm. One of the most influential variants is the RRT* algorithm [17], which improves the original RRT by reducing redundancy and enhancing path optimality. The RRT* employs an optimization strategy based on a minimum-cost path criterion, wherein parent nodes are selected from neighboring vertices to minimize cost, and a rewiring process is conducted to incrementally refine the search tree toward optimality, thereby significantly improving path quality. To reduce computational overhead, Lian [18] proposed the K-dimensional RRT (KD-RRT) algorithm, which utilizes a K-dimensional tree data structure to decrease the number of distance calculations during nearest-neighbor queries. Based on the concept of bidirectional expansion in RRT-Connect, Wang [19] introduced an improved Bidirectional RRT* (Bi-RRT*) algorithm by integrating the principles of Quick-RRT and RRT-Connect, thus accelerating convergence through faster bidirectional tree growth and improved search efficiency. Qiu [20] developed the Dynamic Bridging RRT algorithm, which enhances the search performance of RRT-Connect, thereby enabling safer and more efficient path navigation. Given RRT’s reliance on random sampling, Zhang [21] improved the Bias-RRT by incorporating probabilistic weighting factors into the sampling strategy, effectively reducing randomness and improving planning efficiency. Similarly, Gammell [22] proposed the Informed-RRT* algorithm, which restricts sampling to a progressively shrinking ellipsoidal region defined by the current best path, thereby focusing exploration and reducing path cost. To enhance guidance in complex environments, many improved RRT-based algorithms have incorporated Artificial Potential Field (APF) methods, where attractive forces guide the search toward the goal and repulsive forces prevent collision with obstacles. Yi [23] and Diao [24] integrated APF into their improved Potential-guided RRT* (P-RRT*) and APF-Improved RRT* (APF-IRRT*) algorithms, respectively, demonstrating enhanced adaptability in cluttered environments. Furthermore, Guo [25] proposed the Bidirectional P-RRT* algorithm with adaptive Direction-Biased and Variable-Step (DBVSB-P-RRT*), which integrates multiple advancements, including an adaptive deflection sampling mechanism, an improved formulation of the attractive force in the APF, and a variable step-size heuristic expansion strategy. These enhancements collectively contribute to faster path search and improved path quality.
Motion control ensures accurate joint actuation along planned trajectories [26], enabling smooth tracking and precise end-effector positioning. Its importance has been widely demonstrated in agricultural applications. In greenhouse seedling transplanting, Han [27] reported that advanced control significantly improved accuracy and efficiency. In apple harvesting, Chen [28] showed that force-sensitive strategies effectively reduced fruit damage. In vineyard spraying, Vatavuk [29] found that advanced control enhanced spray uniformity and reduced chemical waste under varying canopy conditions.
Collectively, these studies confirm that robust motion control directly improves the reliability and efficiency of robotic manipulators in real field operations, and it constitutes an essential stage following path planning by generating smooth and executable trajectories under motion constraints [30]. Such constraints enable manipulators to follow planned paths with minimal vibration [31,32], thereby enhancing mechanical durability and extending system lifespan. Several studies have incorporated such constraints into RRT-based algorithms to generate smoother trajectories. Webb [33] proposed the Kinodynamic RRT* algorithm, which integrates dynamic constraints to achieve asymptotically optimal motion planning for robots with linear differential constraints. Kang [34] introduced the Smooth-RRT* algorithm, which considers kinodynamic constraints during the RRT* rewiring process and thereby achieves shorter and smoother trajectories. Liu [35] proposed a Dubins-based RRT variant that optimizes path cost by applying post-processing waypoint shifts, significantly improving path smoothness and efficiency under kinematic constraints. Considering the kinematic characteristics of robotic manipulators, smooth motion control can also be achieved through explicit velocity, acceleration, and jerk constraints. Accordingly, Acceleration/Deceleration (ACC/DEC) algorithms, though traditionally applied in motor control, can be adapted to interpolate trajectories for end-effector motion. The Trapezoid ACC/DEC algorithm [36], though computationally simple, introduces discontinuities in acceleration, often resulting in dynamic shock during transitions. To mitigate this issue, the S-Curve ACC/DEC algorithm [37] introduces a transition phase in the acceleration profile, significantly reducing mechanical impact and producing smoother motion. As a further refinement, the Jerk-Continuous S-Curve ACC/DEC algorithm [38] has been proposed to eliminate jerk discontinuities and reduce flexible impacts caused by abrupt variations in jerk during movement transitions.
The reviewed studies have contributed to notable advancements in path planning and motion control, but several challenges and limitations still persist. In the domain of path search, although Bi-RRT* improves space exploration efficiency, it still lacks sufficient guidance in complex environments. Bias-P-RRT* enhances the target guidance mechanism to improve convergence rates, yet it remains limited in handling obstacle avoidance effectively. With respect to path optimization, the rewiring mechanism in RRT* reduces overall path cost, but redundant nodes still exist. Although the path pruning strategy can eliminate some of this redundancy, further optimization is still possible. In terms of trajectory smoothing, the Jerk-Continuous S-Curve ACC/DEC algorithm enables smooth and stable motion control, but adaptation is required for its effective application in trajectory smoothing.
In response to these challenges, this study proposes the Kinematically Smoothed, dynamically Biased Bidirectional Potential-guided RRT* (KSBB-P-RRT*) algorithm, which performs path planning under kinematic constraints while achieving shorter planning time, lower path cost, and reduced number of iterations. This makes it well suited for fine-grained and precision-demanding applications in robotic manipulators. The main contributions of this paper are summarized as follows:
  • Fast Path Search Strategy: A multi-faceted enhanced search strategy is developed on the basis of Bi-RRT*, where a Dynamic Bias-Sample (DB-Sample) refines sampling guidance and an Adaptive P-Steer (AP-Steer) strengthens obstacle avoidance. Their integration accelerates bidirectional exploration and significantly improves search efficiency.
  • Multi-step Triangle Optimization (MT-Optimize) Strategy: A path optimization strategy, designed on the basis of the triangle inequality, removes redundant waypoints and systematically adjusts remaining nodes, thereby refining the planned path and reducing overall path cost.
  • Kinematically Constrained Smoothing (KC-Smooth) Strategy: A smoothing strategy is designed that incorporates the adaptation of the Jerk-Continuous S-Curve ACC/DEC algorithm to realize trajectory smoothing. This strategy generates a series of continuous trajectory points that are spatially smooth and temporally executable under kinematic constraints, thereby achieving the integration of path planning and motion control.
Figure 1 presents the general block diagram of this study, which illustrates the overall framework of the proposed approach integrating path search, optimization, and smoothing to generate executable trajectories for robotic manipulators. The remainder of this paper is organized as follows. Section 2 reviews the background algorithms, including Bi-RRT* and S-Curve ACC/DEC methods. Section 3 details the proposed KSBB-P-RRT* algorithm and its three key strategies. Section 4 reports comparative experiments against Bi-RRT* and Bias-P-RRT*, and further evaluates the improvements brought by the proposed path optimization and smoothing strategies. Finally, Section 5 summarizes the contributions and outlines future work.

2. Preliminaries

2.1. Bi-RRT* Algorithm

We define the configuration space as a set X [16], where X space denotes the entire search space, X obs the obstacle space, and X free = X space X obs the obstacle-free space. A configuration x X represents a point in the configuration space, where x init X free and x goal X free denote the initial and goal points, respectively. Within X, an RRT is represented as T = ( V , E ) , where V is the set of all nodes in T, and E is the set of edges connecting each node in V to its parent.
The Bi-RRT* algorithm [19], used for path planning, performs path search using a bidirectional tree strategy. The algorithm initializes two trees, T 1 and T 2 , with the initial point x init and the goal point x goal as their respective root nodes. Subsequently, the algorithm alternates between the two trees, sequentially executing sampling and expansion, until a valid connection is formed between T 1 and T 2 , leading to a complete path solution. This bidirectional strategy improves space exploration efficiency and accelerates convergence. However, due to its reliance on purely random sampling, the expansion process lacks guidance and exhibits excessive randomness.
The overall pseudocode [19] of the algorithm is presented in Algorithm 1. The required input parameters include the initial point x init , the goal point x goal , the search space X space , and the upper limit of iterations Iter. Explanations of the functions used in the pseudocode are provided below.
  • Sample: Returns a random sampling point x rand in the search space.
  • Nearest: Returns the nearest node x nearest in the tree to the random point x rand .
  • Steer: Returns a new node by moving a fixed step d step from x nearest towards x rand .
  • CollisionFree: Checks whether the path between two nodes is free of collision.
  • Near: Returns a set of nodes X near near the new node x new within a given radius or number.
  • ChooseParent: Returns the optimal parent node for x new from X near { x nearest } that yields the lowest path cost while ensuring collision-free connectivity.
  • Rewire: Updates the parent nodes of nodes in X near by evaluating whether connecting through x new reduces their individual path costs.
  • Swap: Swaps the two trees.
Algorithm 1 Bi-RRT*( x init , x goal , X space , I t e r )
1:
V 1 { x init } , V 2 { x goal }
2:
E 1 , E 2
3:
T 1 ( V 1 , E 1 ) , T 2 ( V 2 , E 2 )
4:
for  i = 1 to Iter do
5:
     x rand Sample ( i )
6:
     x nearest Nearest ( x rand , T 1 )
7:
     x new Steer ( x nearest , x rand , d step )
8:
    if  CollisionFree ( x nearest , x new , X space )  then
9:
         X near Near ( x new , T 1 )
10:
         x parent ChooseParent ( x new , X near , x nearest )
11:
         V 1 V 1 { x new }
12:
         E 1 E 1 { ( x new , x parent ) }
13:
         T 1 Rewire ( T 1 , x new , X near )
14:
         x nearest 2 Nearest ( x new , T 2 )
15:
        if  CollisionFree ( x nearest 2 , x new , X space ) and x new x nearest 2 2 < δ  then
16:
           return T
17:
        end if
18:
         Swap ( T 1 , T 2 )
19:
    end if
20:
end for
21:
return  T = ( V , E )

2.2. S-Curve ACC/DEC Algorithm

The S-Curve ACC/DEC algorithm is employed in motor control to generate executable trajectories that satisfy kinematic constraints. The algorithm consists of seven sequential phases, with the corresponding profiles of velocity, acceleration, and jerk (i.e., the rate of change of acceleration) illustrated in Figure 2, which is plotted by the authors for clarity based on the description in [39]. By enabling continuous variation in acceleration, the algorithm effectively eliminates sudden changes in acceleration, thereby reducing impact forces and achieving smooth motion control. However, a discontinuity still exists at the level of jerk, which can introduce flexible impacts and vibrations during motion transitions.
We define the following notations for the algorithm planning process. Let s, v, a, j, and t denote displacement, velocity, acceleration, jerk, and time, respectively. The maximum constraints are denoted as v max , a max , and j max , while v s and v e represent the initial and final velocities. Let t i ( i = 0 , 1 , , 7 ) denote the time at each phase, T i = t i t i 1 the duration of the interval from t i 1 to t i , and τ i = t t i 1 the local time coordinate measured from t i 1 . The displacement, velocity, and acceleration at time t i are denoted as S i , V i , and A i , respectively.
The algorithm imposes constraints on the maximum velocity v max , the maximum acceleration a max , and the maximum jerk j max , while also considering the start velocity v s and the end velocity v e for algorithm planning. The velocity profile can be obtained by integrating the acceleration, and the acceleration is defined as follows [39]:
a ( t ) = J τ 1 , 0 t < t 1 A 1 , t 1 t < t 2 A 1 J τ 3 , t 2 t < t 3 0 , t 3 t < t 4 J τ 5 , t 4 t < t 5 A 5 , t 5 t < t 6 A 5 + J τ 7 , t 6 t < t 7
where J = j max , and A i denotes the acceleration at time t i .
To complete the algorithm planning, it is necessary to compute the acceleration values A 1 and A 5 , as well as the time durations T i for each phase. According to the characteristics of the algorithm, T 1 = T 3 and T 5 = T 7 . Taking the acceleration phase ( t 0 to t 3 ) as an example, the following relationships are satisfied [39]:
A 1 = J T 1
V v s = A 1 ( T 1 + T 2 )
where V denotes the peak velocity. The expressions for computing A 1 , T 1 , and T 2 are derived by considering whether a constant acceleration phase is present or not, as follows [39]:
A 1 = a max , T 1 = a max J , T 2 = Δ v a max a max J , if Δ v > a max 2 J A 1 = J Δ v , T 1 = Δ v J , T 2 = 0 , if Δ v a max 2 J
where Δ v = | V v s | . Similarly, for the deceleration phase ( t 4 to t 7 ), based on the symmetry of the algorithm, the parameters A 5 , T 5 , and T 6 can be computed. At this stage, the peak velocity V and the duration of the constant velocity phase T 4 must be determined according to the total displacement S t . The displacements during the acceleration phase S a = S 3 S 0 and deceleration phase S d = S 7 S 4 as well as the displacement constraint are computed as follows [39]:
S a = 1 2 ( v s + V ) ( 2 T 1 + T 2 )
S d = 1 2 ( v e + V ) ( 2 T 5 + T 6 )
S a + S d S t
Assuming V = v max , if the inequality in Equation (7) is satisfied, the algorithm planning can proceed as intended, and the remaining constant velocity duration T 4 is given by the following [39]:
T 4 = S t S a S d v max
Otherwise, if the inequality is not satisfied, no constant velocity phase exists and T 4 = 0 . In this case, the velocity V is progressively reduced using a bisection method or other numerical techniques until Equation (7) is satisfied, thus completing the planning process of the algorithm.

3. KSBB-P-RRT* Algorithm

The proposed KSBB-P-RRT* algorithm achieves shorter planning time, lower path cost, and reduced number of iterations, while enabling motion trajectory smoothing under kinematic constraints to realize efficient path planning and smooth motion control for robotic manipulators. The complete pseudocode of the KSBB-P-RRT* algorithm is presented in Algorithm 2, which was developed by the authors based on the framework of Algorithm 1. The modifications and additional function definitions introduced in this work are explained below.
  • DB_Sample: Returns a random sample from the search space based on the DB-Sample strategy, which adaptively selects a bias point with a probability that changes over iterations.
  • AP_Steer: Returns a new node extended from x nearest to x rand using the AP-Steer strategy, which guides the extension under the influence of the goal point x goal .
  • Optimize_Path: Returns an optimized path with lower cost using the MT-Optimize strategy, which removes redundant nodes and adjusts the positions of waypoints based on geometric heuristics.
  • Smooth_Path: Returns a sequence of smoothed trajectory points using the KC-Smooth strategy, which ensures both spatial and temporal continuity of the trajectory.
Algorithm 2 KSBB-P-RRT*( x init , x goal , X space , I t e r )
1:
V 1 { x init } , V 2 { x goal }
2:
E 1 , E 2
3:
T 1 ( V 1 , E 1 ) , T 2 ( V 2 , E 2 )
4:
for  i = 1 to Iter do
5:
     x rand DB _ Sample ( i )
6:
     x nearest Nearest ( x rand , T 1 )
7:
     x new AP _ Steer ( x nearest , x rand , x goal )
8:
    if  CollisionFree ( x nearest , x new , X space )  then
9:
         X near Near ( x new , T 1 )
10:
         x parent ChooseParent ( x new , X near , x nearest )
11:
         V 1 V 1 { x new }
12:
         E 1 E 1 { ( x new , x parent ) }
13:
         T 1 Rewire ( T 1 , x new , X near )
14:
         x nearest 2 Nearest ( x new , T 2 )
15:
        if  CollisionFree ( x nearest 2 , x new , X space ) and x new x nearest 2 2 < δ  then
16:
           return T
17:
        end if
18:
         Swap ( T 1 , T 2 )
19:
    end if
20:
end for
21:
T Optimize _ Path ( T 1 , T 2 )
22:
T Smooth _ Path ( T )
23:
return  T = ( V , E )
In the path search stage, a Fast Path Search strategy is developed on the basis of the Bi-RRT* framework, with the integration of the DB-Sample strategy, which enhances sampling efficiency by reducing randomness through adaptive guidance, and the AP-Steer strategy, which adaptively adjusts the attractive coefficient and step size based on the environment. These enhancements to both the sampling and expansion strategies effectively realize a fast initial path search.
In the path optimization stage, the MT-Optimize strategy is proposed to refine the initial path by pruning redundant nodes and shortening the path length. The path optimization method trims each node and adjusts waypoints based on the triangle inequality principle, thereby reducing the path cost to enhance the overall quality of the path.
In the trajectory smoothing stage, the KC-Smooth strategy is proposed to generate a final path suitable for direct execution of the end-effector by robotic manipulators. This is achieved by employing an adapted Jerk-Continuous S-Curve ACC/DEC algorithm for trajectory interpolation, which ensures both spatial smoothing of path corners and temporal continuity of motion profiles.

3.1. Fast Path Search Strategy

3.1.1. DB-Sample Strategy

The random sample strategy of conventional algorithms, while theoretically capable of covering the entire search space, often leads to inefficiencies due to the absence of directional guidance, particularly in complex environments. The Bias-Sample strategy [21] in Bias-RRT* improves this by introducing a constant probability of directly selecting the goal point, which helps reduce excessive randomness. However, its fixed nature limits adaptability during different stages of exploration. To address this issue, the DB-Sample strategy is proposed, which dynamically adjusts the biasing behavior over iterations. The pseudocode, written by the authors as an adaptation of the Bias-Sample method, is presented in Algorithm 3, and the key functions are explained as follows:
  • BiasProbability: Returns the current probability of bias, dynamically computed on the basis of the current number of iterations.
  • Rand: Returns a random number within the range [0, 1], used for probabilistic decision making.
Algorithm 3 DB_Sample(i)
1:
x sample Sample ( i )
2:
p bias BiasProbability ( i )
3:
if  Rand ( 0 , 1 ) p bias  then
4:
    if  Rand ( 0 , 1 ) p goal  then
5:
         x rand x goal
6:
    else
7:
         x rand Nearest ( x sample , T 2 )
8:
    end if
9:
else
10:
     x rand x sample
11:
end if
12:
return  x rand
The DB-Sample strategy improves on the conventional Bias-Sample strategy by introducing a dynamic probability p bias to directly sample the dynamic bias point x bias during random sampling. The overall biasing formulation is expressed as follows [21]:
x rand = x bias , if p rand p bias x sample , if p rand > p bias
where x rand denotes the final sampled point, and x sample is a uniformly random sample from the search space. A random probability p rand [ 0 ,   1 ] is generated for sampling decision. If p rand p bias , the bias point x bias is selected; otherwise, the sample point x sample is chosen.
The dynamic probability of bias p bias increases progressively with the number of iterations, thereby ensuring sufficient breadth and depth of exploration throughout the planning process. Specifically, during the early stages of iteration, when the tree contains relatively few nodes, a lower bias probability promotes greater sampling randomness, facilitating broad exploration of the search space. In contrast, during the later stages, when the tree has expanded considerably, the spatial coverage is typically sufficient. At this point, a higher bias probability improves directional guidance, enhancing local refinement and accelerating convergence. The formulation of the dynamic probability p bias , proposed in this work, is given as follows:
p bias = i i max p max , if i i max p max , if i > i max
where p max is the maximum probability of bias and must remain less than 1 to ensure adequate randomness. i is the current number of iterations, and i max is the number of iterations at which p bias reaches its maximum.
The selection of dynamic bias points x bias is proposed as an enhanced strategy based on the Bi-RRT* framework. In this context, two trees are grown, one from the initial point x init (denoted as T 1 ) and the other from the goal point x goal (denoted as T 2 ). Unlike conventional approaches, where each tree selects its own goal as the bias point, the proposed strategy incorporates a fixed probability of selecting a node from the opposing tree as the bias point. This strategy increases the likelihood of a successful connection between the two trees. The selection rule for the bias point x bias , formulated in this study, is defined as follows:
x bias = x goal , if p rand p goal x opposite , if p rand > p goal
where x goal refers to the target point of T 1 (for T 2 , the target point is x init ), x opposite denotes the nearest existing node in the opposite tree to the current random sample x sample , and p goal is the fixed probability of selecting the target point as the bias point.

3.1.2. AP-Steer Strategy

Expansion in traditional algorithms typically proceeds toward random sample points using a fixed step size, which frequently results in excessive iterations and inadequate adaptability in complex environments. In response to this challenge, the P-Steer strategy [40] from the P-RRT* algorithm incorporates the APF method, employing the attractive force of the goal point to perform multi-step expansion and accelerate exploration. However, it lacks effective obstacle avoidance capabilities when encountering large obstacles. To overcome this limitation, this study proposes the AP-Steer strategy that dynamically adjusts the attractive force coefficient in the APF and adapts the expansion step size according to the environment, thus enhancing the adaptability of the algorithm. Algorithm 4 presents the pseudocode of the proposed strategy, which has been adapted from the original P-Steer method for improved applicability, followed by the description of the function.
  • NearestObstacle: Returns the obstacle nearest to x new , used for force computation in the APF.
Algorithm 4 AP_Steer( x nearest , x rand , x goal )
1:
x new Steer ( x nearest , x rand , d step )
2:
for  i 1 to Iter do
3:
     D ( x , x obs ) NearestObstacle ( x new )
4:
    if  D ( x , x obs ) D obs  then
5:
         k a D ( x , x obs ) D ( x , x goal )
6:
         F t k a ( x goal x new ) + ( x new x obs )
7:
    else
8:
         F t ( x goal x new )
9:
    end if
10:
     x new x new + d λ F t F t 2
11:
end for
12:
return  x new
The AP-Steer strategy extends the conventional extension toward x rand with a fixed step size d step , and further performs a multi-step extension with a fixed step size d λ in the direction of the total force computed via the APF. The total force F t is composed of the attractive force F a from the goal x goal and the repulsive force F r from obstacles. However, a fixed attractive coefficient k a is employed in the traditional APF method to guide the tree toward the goal, resulting in limited adaptability in complex environments. When using a fixed attractive coefficient during expansion, if the new node x new moves into a region directly obstructed by obstacles, an excessively large coefficient can hinder x new from successfully bypassing the obstacle. Conversely, if x new enters a relatively open region but is still affected by repulsive forces, an insufficient attractive coefficient may slow the convergence toward the goal. Therefore, an adaptive dynamic attractive coefficient is proposed to accommodate the varying conditions encountered during the expansion process. The formulation builds upon the attractive force computation in [25], and is modified in this work as follows:
k a = D ( x , x obs ) D ( x , x goal ) , D ( x , x obs ) D obs 1 , D ( x , x obs ) > D obs
where D ( x , x goal ) is the distance to the goal, D ( x , x obs ) is the distance to the nearest obstacle, and D obs is the threshold within which repulsion is activated. When the new node x new enters the repulsive field of an obstacle, the attractive coefficient decreases rapidly. The closer it is to the obstacle, the weaker the attractive force becomes. In such cases, the motion is primarily driven by the repulsive force, enabling the expansion to quickly move away from the obstacle region and thereby enhancing obstacle avoidance capability.
In environments with diverse search space scales and obstacle distributions, the fixed step size d step employed in traditional algorithms proves inflexible, as it necessitates manual adjustment to suit specific conditions, resulting in increasing implementation complexity and reducing adaptability. Inspired by the dynamic step-size mechanism in [41], this study proposes an adaptive computation method for d step , which considers the range and dimensionality of the search space as well as the obstacle occupancy ratio, and is formulated as follows:
d step = 1 γ D avg N dim ( 1 R obs )
where γ is the step adjustment coefficient, D avg is the average search range per dimension, N dim is the number of dimensions, and R obs is the ratio of obstacle area (or volume) to the total space.

3.2. MT-Optimize Strategy

Although the DB-Sample and AP-Steer strategies enhance planning speed, the resulting initial path still requires optimization to achieve higher quality. Consequently, the MT-Optimize strategy is proposed in this study, comprising three stages.
As the first stage, a pruning strategy [42] is employed to remove redundant nodes from the generated path, as shown in Figure 3. Starting from the initial point x i n i t , the strategy attempts to connect it sequentially with subsequent nodes along the path. When the line segment connecting x i n i t to x 3 collides with an obstacle, the previous node x 2 is selected as the next path point, and the intermediate point x 1 is considered redundant and removed. This process is repeated iteratively by traversing all remaining path points to eliminate any redundant nodes along the trajectory.
As the second stage, this study proposes a path-shortening strategy based on the triangle inequality, applied after the initial path pruning. The objective is to further minimize the overall path cost by iteratively adjusting intermediate waypoints. Specifically, for each waypoint with two neighboring nodes, the point can be shifted within the triangle formed by these three nodes to potentially reduce the total path length. As illustrated in Figure 4, which is drawn by the authors for clarity, the optimization of a waypoint x 1 , situated between x 0 and x 2 , is carried out in three steps. First, in Figure 4a, a preprocessing step similar to the pruning strategy is applied. If the direct connection between x 0 and x 2 does not intersect any obstacles, then x 1 is deemed redundant and removed, and the remaining two steps are skipped. If a collision occurs, in Figure 4a, the second step proceeds by moving x 1 incrementally toward x 0 with a fixed minimum step size d, until the segment between the updated position and x 2 intersects with an obstacle. The last collision-free position is retained as x 1 . Third, in Figure 4b, using a method similar to the second step, the intermediate point x 1 is further moved toward x 2 until a final optimized position x 1 is obtained, which replaces the original waypoint x 1 . This process is applied iteratively to all eligible waypoints in the path. Optimization terminates when no further redundant nodes exist and point positions converge. The resulting path tightly conforms to obstacle boundaries while achieving a lower overall path cost.
As the third stage, this study proposes a path refinement strategy to address potential issues introduced by the previous shortening process. Specifically, due to the influence of obstacle contours, the optimized path may occasionally yield adjacent waypoints that are overly close to each other, which adversely affects subsequent trajectory smoothing. To resolve this, a threshold distance d limit is defined, and the path refinement process is illustrated by the authors in Figure 5. If the distance between two consecutive waypoints x 1 and x 2 is below the threshold d limit , a corrective step is performed. An intersection point x new is computed between the lines defined by points x 0 , x 1 and x 3 , x 2 , and this point replaces both x 1 and x 2 . This extension-and-merge operation is applied iteratively along the entire path to eliminate overly close waypoints. Through this process, the overall path optimization is finalized, generating a higher-quality path. Although this correction may slightly increase the path cost, it provides additional planning space for subsequent smoothing, and thus the overall path quality can still be considered improved.

3.3. KC-Smooth Strategy

Traditional interpolation-based smoothing methods, such as cubic spline interpolation, may generate poorly constrained trajectories, which in turn increase the likelihood of collisions with obstacles. Moreover, such methods typically ignore physical constraints such as kinematics, which results in planned paths that are not directly executable and therefore require additional trajectory tracking algorithms to compensate for feasibility issues. In response to these limitations, this study proposes the KC-Smooth strategy, which integrates trajectory planning and control, allowing collision checking during smoothing and direct incorporation of kinematic constraints into the interpolation process. As a result, the generated trajectory points can be directly utilized as finely controlled end-effector motion commands for execution by the manipulator.
The KC-Smooth strategy consists of both spatial and temporal components. Spatially, corner regions around waypoints are smoothed using curve transitions, while the remaining segments retain straight-line paths, ensuring controllability of the smoothed trajectory. Temporally, constant velocity motion is maintained along linear segments, and smooth velocity transitions are achieved at the initial point, the goal point, and each corner via kinematic profile planning, promoting smooth and stable execution of the overall motion. To implement the KC-Smooth strategy, it is necessary to determine the positions and velocities at the start and end of each corner smoothing segment, as illustrated by the authors in Figure 6. An appropriately adapted ACC/DEC algorithm is proposed to perform trajectory planning at the corners.
A Jerk-Continuous S-Curve ACC/DEC algorithm [38] is employed to ensure smooth motion by mitigating the impact caused by abrupt acceleration changes and the flexible vibration induced by sudden jerk transitions. This algorithm replaces the linear acceleration phase of traditional S-Curve ACC/DEC with a cosine-based fitting function, yielding a continuous jerk profile. To apply this algorithm for corner smoothing, appropriate adaptations are required. Spatially, the original algorithm is designed for linear motion control; thus, its kinematic quantities must be reformulated as spatial vectors. Temporally, only the acceleration phase (from t 0 to t 3 , as shown in Figure 2) is used to achieve smooth transitions between start and end velocity vectors at the corners. The adapted acceleration and jerk profiles are illustrated in Figure 7.
The adapted Jerk-Continuous S-Curve ACC/DEC algorithm imposes kinematic constraints on the maximum velocity v max , maximum acceleration a max , and maximum jerk j max . We define the bold symbols x , v , a , and j as the vector forms of position, velocity, acceleration, and jerk, respectively. Building on the formulation in [38], the acceleration vector a ( t ) is adapted in this study as follows:
a ( t ) = A 2 ( 1 cos π τ 1 T 1 ) , 0 t < t 1 A , t 1 t < t 2 A 2 ( 1 + cos π τ 3 T 1 ) , t 2 t < t 3
where A represents the peak acceleration vector. The corresponding velocity vector v ( t ) and position vector x ( t ) are derived by integrating a ( t ) over time [38]:
v ( t ) = v s + 0 t a ( t ) d t , 0 t < t 3
x ( t ) = x s + 0 t v ( t ) d t , 0 t < t 3
where v s , v e , and x s , x e represent the velocity and position vectors at the start and end of the corner smoothing segment, respectively, within which the trajectory smoothing is performed. Based on equivalent calculations, the jerk vector in the S-Curve ACC/DEC algorithm is defined as J = 2 π j max , and the peak velocity vector is given by V = v e . Using these formulations, the peak acceleration vector A , the time intervals T 1 , T 2 , and the displacement from x s to x e can be computed via Equations (4) and (5). Ultimately, the problem is reduced to trajectory planning based on the start and end velocity vectors v s and v e .
By applying the adapted Jerk-Continuous S-Curve ACC/DEC algorithm, the position and velocity vectors at the start and end of each corner smoothing segment are planned. This enables the completion of both path smoothing and motion trajectory generation. The detailed steps of the KC-Smooth strategy proposed in this study are described below.
Step 1: Preplan the start and end velocity vectors ( v s i and v e i ) corresponding to each corner point x i ( i = 1 , 2 ), as illustrated in Figure 6. The pre-planning begins by assuming a maximum velocity magnitude v max , which is then reduced iteratively based on the motion distance and collision constraints until all feasibility conditions are satisfied.
Step 2: Determine the constant velocity for each linear path segment. For a segment connecting x 1 and x 2 shown in Figure 6, the uniform velocity is defined as the vector with the smaller magnitude between the end velocity v e 1 of the preceding corner and the start velocity v s 2 of the subsequent corner. This approach is applied consistently across all segments to ensure smooth transitions.
Step 3: Perform trajectory point interpolation. Based on the planned constant velocities, the trajectory is smoothed by incrementally integrating over time using the Equations (14)–(16) from the adapted Jerk-Continuous S-Curve ACC/DEC algorithm. This process yields a continuous and kinematically feasible trajectory along the entire path.

4. Simulation and Results

Through simulation experiments, the proposed KSBB-P-RRT* algorithm is compared with the Bi-RRT* and Bias-P-RRT* algorithms to evaluate overall planning performance. In addition, the effectiveness of path optimization and trajectory smoothing is also assessed independently. The simulations are conducted on an Intel i9-13900HX CPU (Intel, Santa Clara, CA, USA) with 16 GB of RAM, running on an HP Omen 9 laptop (HP Inc., Palo Alto, CA, USA). All algorithms are implemented using Python 3.10.16.

4.1. Simulation Environment Setup

The proposed algorithms are tested in both 2D and 3D environments, each comprising two levels of complexity, simple and complex maps, as illustrated in Figure 8.
Figure 8a,b depict the 2D environments. The search space is defined as a 100 × 100 unit area, containing multiple black rectangles and circles representing obstacles. Each obstacle is inflated with a buffer radius of 3 units. The unit and goal points are marked by green and red dots, respectively, located at coordinates (5, 5) and (95, 95). Figure 8a represents a simple 2D environment with fewer but larger obstacles, while Figure 8b shows a more complex 2D environment with a greater number of smaller obstacles.
Figure 8c,d present the 3D environments. The search space spans 100 × 100 × 100 units, where obstacles are represented by semi-transparent green spheres, also inflated with a 3-unit buffer radius. The unit and goal points are positioned at coordinates (0, 0, 0) and (100, 100, 100), respectively. Figure 8c illustrates a simple 3D environment with fewer but larger obstacles, whereas Figure 8d corresponds to a complex 3D environment with a larger number of smaller obstacles.

4.2. Trajectory Planning Performance Analysis of RRT-Based Algorithms

To evaluate planning performance, the three algorithms Bi-RRT*, Bias-P-RRT*, and the proposed KSBB-P-RRT* were tested in the four aforementioned environments, producing 3 × 4 experimental groups. A successful trial was defined as the generation of a collision-free path from the initial position to the goal position. Performance was evaluated using four key metrics: planning time T, path cost C, number of iterations I, and success rate. To mitigate the influence of randomness, each algorithm was executed 100 times per scenario, with the average values of these performance metrics serving as the primary basis for comparison.

4.2.1. Parameter Settings

The parameter settings are summarized in Table 1, where d step denotes the initial step size. For Bi-RRT* and Bias-P-RRT*, the step size is fixed at 5 in 2D environments and 7 in 3D environments. In contrast, KSBB-P-RRT* employs an adaptive step size mechanism, where γ is the step size adjustment coefficient. I t e r represents the upper limit of iterations, N rewire is the maximum number of neighboring nodes considered during rewiring, D obs denotes the obstacle repulsion distance, d λ represents the base step size used for multi-step extension, and p bias is the probability of goal-biased sampling.

4.2.2. Experimental Data

Based on 100 runs per scenario, the relevant performance metrics of the three algorithms across four benchmark environments (as illustrated in Figure 8) are summarized in Table 2. Here, T avg represents the average planning time, C avg denotes the average path cost, I avg indicates the average number of iterations, and I max corresponds to the maximum number of iterations observed among all trials. Due to the relatively high upper limit allowable for iterations, all three algorithms achieved a success rate of 100%. Therefore, the subsequent analysis focuses on the remaining three metrics.

4.2.3. Data Comparison of Planning Time

In terms of planning time, as shown in the T avg column of Table 2, Bi-RRT* exhibits moderate adaptability across all environments. However, in complex environments with dense obstacles, its lack of goal-directed guidance results in significantly longer planning times. Bias-P-RRT* incurs longer planning times in simple environments with large obstacles. This is mainly due to the overly strong attraction toward the goal, which makes it difficult for the planner to move away from nearby obstacles. In contrast, KSBB-P-RRT* integrates the strengths of both previous algorithms and shows consistently superior performance across all environments. Compared to Bi-RRT*, it reduces the average planning time by 36.85%, 33.37%, 55.91%, and 70.35% in the four environments. Compared to Bias-P-RRT*, the reductions are 57.14%, 18.83%, 84.07%, and 67.62%, respectively. These results demonstrate that KSBB-P-RRT* significantly improves planning efficiency, especially in 3D environments. This efficiency gain is primarily attributed to the use of the DB-Sample strategy, which facilitates more effective goal-biased sampling, and the AP-Steer strategy enables adaptive extension toward feasible directions. The reduction in planning time supports faster exploration and convergence, which is favorable for responsive and efficient motion planning.

4.2.4. Data Comparison of Path Cost

In terms of path cost, as shown in the C avg column of Table 2, the Bias-P-RRT* algorithm, which uses the goal as an attractive guide, generally produces lower path cost than Bi-RRT* across all environments. Building on this advantage, KSBB-P-RRT* further improves path quality by applying the MT-Optimize and KC-Smooth strategies. Compared to Bi-RRT*, it reduces the average path cost by 3.36%, 6.41%, 8.11%, and 6.27% across the four environments. Compared to Bias-P-RRT*, the reductions are 0.43%, 2.79%, 0.67%, and 0.72%. These results validate the superior path quality of KSBB-P-RRT* across diverse scenarios. This improvement is primarily due to the use of MT-Optimize, which removes redundant segments and reduces path tortuosity, and KC-Smooth, which smooths sharp corners along the path. Together, these strategies produce more concise and efficient trajectories, resulting in a lower overall path cost. Minimizing path cost is theoretically beneficial for reducing energy expenditure during execution, potentially supporting more efficient and reliable manipulator operation.

4.2.5. Data Comparison of Number of Iterations

The number of iterations reflects both the success rate of expansion attempts and the adaptability of the algorithm to the environment, as indicated by the I avg and I max columns in Table 2. In the simple 3D environment, both Bi-RRT* and Bias-P-RRT* required over 200 iterations on average. According to the maximum number of iterations observed in all trials, it can be inferred that reducing the upper limit of iterations to 800 would cause the success rates of these two algorithms to fall below 100%. This is mainly because the large obstacles in the environment pose significant challenges: Bi-RRT*, despite its efficient sampling, lacks effective obstacle avoidance strategies, while Bias-P-RRT*, although incorporating the APF method, still struggles to navigate around large obstacles. These limitations result in frequent expansion failures and an increased number of iterations for both algorithms. In contrast, KSBB-P-RRT* maintains an average number of iterations below 100 across all environments and continues to achieve a high success rate even when the upper limit of iterations is relatively low. This performance is attributed to the use of the AP-Steer strategy, which adaptively adjusts the step size and attractive force coefficients based on the proximity and distribution of surrounding obstacles, thereby enhancing both search efficiency and obstacle avoidance capability. Reducing the number of iterations is expected to enhance planning stability and mitigate computational burden, especially in time-sensitive manipulation scenarios.

4.2.6. Visualization Comparison of Planned Paths

To provide an intuitive comparison, Figure 9, Figure 10, Figure 11 and Figure 12 illustrate the planned paths of the three algorithms, with each figure showing a representative result selected from 100 runs in each scenario.
The red line indicates the final planned path, while the blue lines represent the branches of the search tree. Compared to Bi-RRT* and Bias-P-RRT*, the proposed KSBB-P-RRT* generates fewer redundant tree branches and produces smoother, more natural paths for execution, demonstrating enhanced convergence and path quality. This performance benefit results from the integration of the DB-Sample strategy for more goal-directed sampling, the AP-Steer strategy for adaptive tree extension, the MT-Optimize strategy for reducing path tortuosity, and the KC-Smooth strategy for smoothing sharp transitions along the path. The algorithm yields continuous and kinematically consistent trajectory points, promoting smooth and stable motion along the planned path.

4.3. Comparison of Optimization Performance at Sequential Planning Phases

The proposed algorithm incorporates the MT-Optimize and KC-Smooth strategies for path refinement. To evaluate the effectiveness of these optimization stages, a comparative analysis is performed. Specifically, the average results from the above 100-run experiments in each benchmark environment are used to compare the path costs at different optimization stages. Table 3 summarizes the average path costs at three optimization phases across the four environments. Here, C init denotes the initial average path cost obtained using the DB-Sample and AP-Steer strategies; C opt represents the average path cost after applying MT-Optimize; and C smooth corresponds to the final average path cost after further applying KC-Smooth.
The MT-Optimize strategy eliminates redundant waypoints from the initial path and adjusts remaining waypoints toward directions with lower cost. This adjustment reduces the average path cost by 4.25%, 3.51%, 6.95%, and 4.87% across the four environments. The subsequent application of the KC-Smooth strategy smooths the corner regions of the path, and the total reductions in average path cost reach 6.94%, 5.40%, 8.16%, and 4.97% compared to the initial path. These results demonstrate that the optimization process effectively reduces path cost, thereby minimizing energy consumption in practical applications.

4.4. Evaluation of Smoothing Effects Under Kinematic Constraints

Trajectory smoothing is performed using the KC-Smooth strategy. Figure 13, Figure 14, Figure 15 and Figure 16 present the analysis of its impact on motion-level smoothness under kinematic constraints by illustrating the magnitude profiles of key kinematic parameters. Specifically, we evaluate whether the key kinematic parameters (velocity, acceleration, and jerk) satisfy the predefined constraint limits and exhibit temporal continuity throughout the trajectory. In the experiments, the constraint limits for velocity, acceleration, and jerk are all set to 50. In each figure, the gray dashed line represents the constraint threshold, while the colored solid lines indicate the magnitude profiles of the corresponding kinematic parameters.
After applying KC-Smooth, the magnitude profiles of velocity, acceleration, and jerk remain entirely within the specified constraint limits in all environments and show consistent temporal continuity. The velocity magnitude curves demonstrate smooth transitions and maintain near-constant speed within each segment. The acceleration profiles closely fit the expected curves of the adapted Jerk-Continuous S-Curve ACC/DEC algorithm, and the jerk profiles show no abrupt changes. These results indicate that KC-Smooth effectively achieves motion smoothness that meets the requirements for stable execution. By ensuring continuous transitions in motion, it reduces impact forces caused by sudden changes in acceleration, as well as flexible vibrations induced by jerk discontinuities. The resulting motion smoothness is conducive to stable system behavior and may help mitigate mechanical stress and extend operational longevity.

4.5. Discussion of Results

Based on the preceding comparative analysis, the proposed KSBB-P-RRT* demonstrates clear advantages over the other two algorithms in terms of planning time, path cost, and number of iterations. Its superior performance can be attributed to targeted improvements in the following aspects.
  • Fast Path Search Strategy: Building on Bi-RRT*, the DB-Sample strategy is introduced to dynamically adjust the sampling point at each iteration, balancing the breadth and depth of exploration. In addition, the AP-Steer strategy is incorporated to enable adaptive expansion and enhance obstacle avoidance capability. These combined improvements significantly enhance the adaptability of the algorithm to diverse environments, resulting in reduced planning time across all scenarios and a substantial decrease in the number of iterations, thereby achieving fast and efficient path search.
  • MT-Optimize Strategy: Based on the triangle inequality principle, redundant waypoints in the initial path are removed, while the remaining waypoints are adjusted to yield paths that better conform to obstacle boundaries. This refinement effectively reduces the overall path cost across different environments.
  • KC-Smooth Strategy: An adapted Jerk-Continuous S-Curve ACC/DEC algorithm is introduced for trajectory smoothing, which reduces path cost to some extent by refining corner transitions. At the same time, temporal kinematic constraints are satisfied, enabling the planned path to be directly executable and ensuring smooth motion control.

5. Conclusions

In this study, the KSBB-P-RRT* algorithm was proposed to address the challenges of robotic manipulator path planning under kinematic constraints. The algorithm achieves shorter planning time, lower path cost, and reduced number of iterations, making it suitable for fine-grained and precision-demanding applications. Its contributions can be summarized as follows. First, a fast path search strategy integrates a DB-Sample for improved sampling guidance with an AP-Steer for enhanced obstacle avoidance, thereby accelerating bidirectional exploration. Second, an MT-Optimize strategy removes redundant waypoints and adjusts remaining nodes based on the triangle inequality, effectively reducing path cost. Third, a KC-Smooth strategy adapts the Jerk-Continuous S-Curve ACC/DEC algorithm to generate continuous trajectory points, which are both spatially smooth and temporally executable, thus integrating path planning with motion control.
Across four benchmarks, KSBB-P-RRT* reduced planning time by 33–70% and path cost by 3–8% relative to Bi-RRT*, while requiring fewer iterations. Moreover, the generated trajectories satisfy kinematic constraints, supporting continuity and feasibility in tracking scenarios. These quantitative improvements demonstrate effectiveness of the proposed method in simulation and suggest its strong potential in tasks requiring smooth and reliable motion planning in complex environments.
Future work will focus on implementing the proposed KSBB-P-RRT* algorithm on real-time robotic platforms to further validate its applicability and effectiveness under real-world conditions. Moreover, since the algorithm primarily addresses end-effector trajectory planning in task space, the corresponding joint trajectories will need to be derived through inverse kinematics according to the specific manipulator configuration.
Despite the promising results, this study has several limitations. In particular, the current experiments are restricted to simulation scenarios with static obstacles, which limits the applicability of the method in dynamic and uncertain environments. Future research may also consider extending the algorithm to dynamic scenarios, including real-time path planning and obstacle avoidance.

Author Contributions

Y.L.: writing—review and editing, writing—original draft, visualization, validation, software, project administration, methodology, investigation, formal analysis, data curation, conceptualization. H.L.: writing—review and editing, validation, formal analysis, conceptualization, software, methodology. Z.Y.: supervision, resources, project administration, formal analysis. Y.S.: supervision, funding acquisition. All authors have read and agreed to the published version of the manuscript.

Funding

This research was funded by the National Natural Science Foundation of China (Grant Number: 32171908) and the Jiangsu Agricultural Science and Technology Innovation Fund (Grant Number: CX(24)3025).

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 upon request.

Conflicts of Interest

The authors declare that they have no known competing financial interests or personal relationships that could have appeared to influence the work reported in this paper.

References

  1. Wu, H.; Wang, X.; Chen, X.; Zhang, Y.; Zhang, Y. Review on Key Technologies for Autonomous Navigation in Field Agricultural Machinery. Agriculture 2025, 15, 1297. [Google Scholar] [CrossRef]
  2. Lu, E.; Xu, L.; Li, Y.; Tang, Z.; Ma, Z. Modeling of working environment and coverage path planning method of combine harvesters. Int. J. Agric. Biol. Eng. 2020, 13, 132–137. [Google Scholar] [CrossRef]
  3. Cui, B.; Cui, X.; Wei, X.; Zhu, Y.; Ma, Z.; Zhao, Y.; Liu, Y. Design and Testing of a Tractor Automatic Navigation System Based on Dynamic Path Search and a Fuzzy Stanley Model. Agriculture 2024, 14, 2136. [Google Scholar] [CrossRef]
  4. Lu, E.; Ma, Z.; Li, Y.; Xu, L.; Tang, Z. Adaptive backstepping control of tracked robot running trajectory based on real-time slip parameter estimation. Int. J. Agric. Biol. Eng. 2020, 13, 178–187. [Google Scholar] [CrossRef]
  5. Jin, Y.; Liu, J.; Xu, Z.; Yuan, S.; Li, P.; Wang, J. Development status and trend of agricultural robot technology. Int. J. Agric. Biol. Eng. 2021, 14, 1–19. [Google Scholar] [CrossRef]
  6. Wu, Q.; Gu, J. Design and research of robot visual servo system based on artificial intelligence. Agro Food Ind.-Tech 2017, 28, 125–128. [Google Scholar]
  7. Xie, F.; Guo, Z.; Li, T.; Feng, Q.; Zhao, C. Dynamic Task Planning for Multi-Arm Harvesting Robots Under Multiple Constraints Using Deep Reinforcement Learning. Horticulturae 2025, 11, 88. [Google Scholar] [CrossRef]
  8. Chen, W.; Xu, T.; Liu, J.; Wang, M.; Zhao, D. Picking robot visual servo control based on modified fuzzy neural network sliding mode algorithms. Electronics 2019, 8, 605. [Google Scholar] [CrossRef]
  9. Xu, Z.; Liu, J.; Wang, J.; Cai, L.; Jin, Y.; Zhao, S.; Xie, B. Realtime picking point decision algorithm of trellis grape for high-speed robotic cut-and-catch harvesting. Agronomy 2023, 13, 1618. [Google Scholar] [CrossRef]
  10. Guan, X.; Shi, L.; Ge, H.; Ding, Y.; Nie, S. Development, Design, and Improvement of an Intelligent Harvesting System for Aquatic Vegetable Brasenia schreberi. Agronomy 2025, 15, 1451. [Google Scholar] [CrossRef]
  11. Liu, Z.; Sampurno, R.M.; Abeyrathna, R.R.D.; Nakaguchi, V.M.; Ahamed, T. Development of a Collision-Free Path Planning Method for a 6-DoF Orchard Harvesting Manipulator Using RGB-D Camera and Bi-RRT Algorithm. Sensors 2024, 24, 8113. [Google Scholar] [CrossRef] [PubMed]
  12. Yoshida, T.; Onishi, Y.; Kawahara, T.; Fukao, T. Automated harvesting by a dual-arm fruit harvesting robot. ROBOMECH J. 2022, 9, 19. [Google Scholar] [CrossRef]
  13. Dai, Y.; Xiang, C.; Zhang, Y.; Jiang, Y.; Qu, W.; Zhang, Q. A review of spatial robotic arm trajectory planning. Aerospace 2022, 9, 361. [Google Scholar] [CrossRef]
  14. Kavraki, L.E.; Svestka, P.; Latombe, J.C.; Overmars, M.H. Probabilistic roadmaps for path planning in high-dimensional configuration spaces. IEEE Trans. Robot. Autom. 1996, 12, 566–580. [Google Scholar] [CrossRef]
  15. Hart, P.E.; Nilsson, N.J.; Raphael, B. A formal basis for the heuristic determination of minimum cost paths. IEEE Trans. Syst. Sci. Cybern. 1968, 4, 100–107. [Google Scholar] [CrossRef]
  16. LaValle, S. Rapidly-exploring random trees: A new tool for path planning. In Research Report 9811; Iowa State University: Ames, IA, USA, 1998; Available online: https://msl.cs.illinois.edu/~lavalle/papers/Lav98c.pdf (accessed on 2 September 2025).
  17. Karaman, S.; Frazzoli, E. Incremental sampling-based algorithms for optimal motion planning. Robot. Sci. Syst. VI 2010, 104, 267–274. [Google Scholar]
  18. Lian, J.; Cui, C.; Sun, W.; Wu, Y.; Huang, R. KD-RRT: Restricted Random Testing based on K-Dimensional Tree. In Proceedings of the 2021 8th International Conference on Dependable Systems and Their Applications (DSA), Yinchuan, China, 11–12 September 2021; pp. 590–599. [Google Scholar]
  19. Wang, B.; Ju, D.; Xu, F.; Feng, C. Bi-RRT*: An improved bidirectional RRT* path planner for robot in two-dimensional space. IEEJ Trans. Electr. Electron. Eng. 2023, 18, 1639–1652. [Google Scholar] [CrossRef]
  20. Qiu, S.; Li, B.; Tong, R.; He, X.; Tang, C. Efficient Path Planning Based on Dynamic Bridging Rapidly Exploring Random Tree. Appl. Sci. 2024, 14, 2032. [Google Scholar] [CrossRef]
  21. Zhang, H.; Xie, X.; Wei, M.; Wang, X.; Song, D.; Luo, J. An Improved Goal-bias RRT algorithm for Unmanned Aerial Vehicle Path Planning. In Proceedings of the 2024 IEEE International Conference on Mechatronics and Automation (ICMA), Tianjin, China, 4–7 August 2024; pp. 1360–1365. [Google Scholar]
  22. Gammell, J.D.; Srinivasa, S.S.; Barfoot, T.D. Informed RRT*: Optimal sampling-based path planning focused via direct sampling of an admissible ellipsoidal heuristic. In Proceedings of the 2014 IEEE/RSJ International Conference on Intelligent Robots and Systems, Chicago, IL, USA, 14–18 September 2014; pp. 2997–3004. [Google Scholar]
  23. Yi, J.; Yuan, Q.; Sun, R.; Bai, H. Path planning of a manipulator based on an improved P_RRT* algorithm. Complex Intell. Syst. 2022, 8, 2227–2245. [Google Scholar] [CrossRef]
  24. Diao, Q.; Zhang, J.; Liu, M.; Yang, J. A disaster relief UAV path planning based on APF-IRRT* fusion algorithm. Drones 2023, 7, 323. [Google Scholar] [CrossRef]
  25. Guo, S.; Gong, J.; Shen, H.; Yuan, L.; Wei, W.; Long, Y. DBVSB-P-RRT*: A path planning algorithm for mobile robot with high environmental adaptability and ultra-high speed planning. Expert Syst. Appl. 2025, 266, 126123. [Google Scholar] [CrossRef]
  26. Liu, J.; Liang, J.; Zhao, S.; Jiang, Y.; Wang, J.; Jin, Y. Design of a virtual multi-interaction operation system for hand–eye coordination of grape harvesting robots. Agronomy 2023, 13, 829. [Google Scholar] [CrossRef]
  27. Han, L.; Mao, H.; Kumi, F.; Hu, J. Development of a multi-task robotic transplanting workcell for greenhouse seedlings. Appl. Eng. Agric. 2018, 34, 335–342. [Google Scholar] [CrossRef]
  28. Chen, K.; Li, T.; Yan, T.; Xie, F.; Feng, Q.; Zhu, Q.; Zhao, C. A soft gripper design for apple harvesting with force feedback and fruit slip detection. Agriculture 2022, 12, 1802. [Google Scholar] [CrossRef]
  29. Vatavuk, I.; Vasiljević, G.; Kovačić, Z. Task space model predictive control for vineyard spraying with a mobile manipulator. Agriculture 2022, 12, 381. [Google Scholar] [CrossRef]
  30. Tai, S.; Tang, Z.; Li, B.; Wang, S.; Guo, X. Intelligent Recognition and Automated Production of Chili Peppers: A Review Addressing Varietal Diversity and Technological Requirements. Agriculture 2025, 15, 1200. [Google Scholar] [CrossRef]
  31. Faheem, M.; Liu, J.; Chang, G.; Ahmad, I.; Peng, Y. Hanging force analysis for realizing low vibration of grape clusters during speedy robotic post-harvest handling. Int. J. Agric. Biol. Eng. 2021, 14, 62–71. [Google Scholar] [CrossRef]
  32. Ji, W.; Qian, Z.; Xu, B.; Tang, W.; Li, J.; Zhao, D. Grasping damage analysis of apple by end-effector in harvesting robot. J. Food Process. Eng. 2017, 40, e12589. [Google Scholar] [CrossRef]
  33. Webb, D.J.; Van Den Berg, J. Kinodynamic RRT*: Asymptotically optimal motion planning for robots with linear dynamics. In Proceedings of the 2013 IEEE International Conference on Robotics and Automation, Karlsruhe, Germany, 6–10 May 2013; pp. 5054–5061. [Google Scholar]
  34. Kang, Y.; Yang, Z.; Zeng, R.; Wu, Q. Smooth-RRT*: Asymptotically optimal motion planning for mobile robots under kinodynamic constraints. In Proceedings of the 2021 IEEE International Conference on Robotics and Automation (ICRA), Xi’an, China, 30 May–5 June 2021; pp. 8402–8408. [Google Scholar]
  35. Liu, S.; Zhao, Z.; Wei, J.; Zhou, Q. Kinematic Constrained RRT Algorithm with Post Waypoint Shift for the Shortest Path Planning of Wheeled Mobile Robots. Sensors 2024, 24, 6948. [Google Scholar] [CrossRef]
  36. Jeon, J.W.; Ha, Y.Y. A generalized approach for the acceleration and deceleration of industrial robots and CNC machine tools. IEEE Trans. Ind. Electron. 2000, 47, 133–139. [Google Scholar] [CrossRef]
  37. Chen, Y.; Ji, X.; Tao, Y.; Wei, H. Look-ahead algorithm with whole S-curve acceleration and deceleration. Adv. Mech. Eng. 2013, 5, 974152. [Google Scholar] [CrossRef]
  38. Ni, H.; Yuan, J.; Ji, S.; Zhang, C.; Hu, T. Feedrate scheduling of NURBS interpolation based on a novel jerk-continuous ACC/DEC algorithm. IEEE Access 2018, 6, 66403–66417. [Google Scholar] [CrossRef]
  39. Li, Z.; Cai, L.; Liu, Z. Efficient Planning and Solving Algorithm of S-Shape Acceleration and Deceleration. Wirel. Commun. Mob. Comput. 2020, 2020, 8884678. [Google Scholar] [CrossRef]
  40. Xu, X.; Zhang, F.; Zhao, Y. Unmanned aerial vehicle path-planning method based on improved P-RRT* algorithm. Electronics 2023, 12, 4576. [Google Scholar] [CrossRef]
  41. Feng, Z.; Zhou, L.; Qi, J.; Hong, S. DBVS-APF-RRT*: A global path planning algorithm with ultra-high speed generation of initial paths and high optimal path quality. Expert Syst. Appl. 2024, 249, 123571. [Google Scholar] [CrossRef]
  42. 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]
Figure 1. General framework of the proposed KSBB-P-RRT* algorithm.
Figure 1. General framework of the proposed KSBB-P-RRT* algorithm.
Sensors 25 05598 g001
Figure 2. Velocity, acceleration, and jerk profiles of the S-Curve ACC/DEC algorithm.
Figure 2. Velocity, acceleration, and jerk profiles of the S-Curve ACC/DEC algorithm.
Sensors 25 05598 g002
Figure 3. Illustration of the pruning process for eliminating redundant nodes in the initial path.
Figure 3. Illustration of the pruning process for eliminating redundant nodes in the initial path.
Sensors 25 05598 g003
Figure 4. Illustration of the three-step path shortening strategy applied to a representative waypoint. Blue denotes the waypoint adjustment direction, and red the new path after fixation.
Figure 4. Illustration of the three-step path shortening strategy applied to a representative waypoint. Blue denotes the waypoint adjustment direction, and red the new path after fixation.
Sensors 25 05598 g004
Figure 5. Illustration of the path repair strategy for handling overly close adjacent waypoints.
Figure 5. Illustration of the path repair strategy for handling overly close adjacent waypoints.
Sensors 25 05598 g005
Figure 6. Illustration of corner smoothing under kinematic constraints for motion trajectory generation.
Figure 6. Illustration of corner smoothing under kinematic constraints for motion trajectory generation.
Sensors 25 05598 g006
Figure 7. Acceleration and jerk profiles of the adapted Jerk-Continuous S-Curve ACC/DEC algorithm.
Figure 7. Acceleration and jerk profiles of the adapted Jerk-Continuous S-Curve ACC/DEC algorithm.
Sensors 25 05598 g007
Figure 8. Test benchmark environments: (a,b) 2D maps and (c,d) 3D maps with varying obstacle complexity.
Figure 8. Test benchmark environments: (a,b) 2D maps and (c,d) 3D maps with varying obstacle complexity.
Sensors 25 05598 g008
Figure 9. Simulation results of the three algorithms in the simple 2D environment.
Figure 9. Simulation results of the three algorithms in the simple 2D environment.
Sensors 25 05598 g009
Figure 10. Simulation results of the three algorithms in the complex 2D environment.
Figure 10. Simulation results of the three algorithms in the complex 2D environment.
Sensors 25 05598 g010
Figure 11. Simulation results of the three algorithms in the simple 3D environment.
Figure 11. Simulation results of the three algorithms in the simple 3D environment.
Sensors 25 05598 g011
Figure 12. Simulation results of the three algorithms in the complex 3D environment.
Figure 12. Simulation results of the three algorithms in the complex 3D environment.
Sensors 25 05598 g012
Figure 13. Velocity, acceleration, and jerk magnitude profiles in the simple 2D environment.
Figure 13. Velocity, acceleration, and jerk magnitude profiles in the simple 2D environment.
Sensors 25 05598 g013
Figure 14. Velocity, acceleration, and jerk magnitude profiles in the complex 2D environment.
Figure 14. Velocity, acceleration, and jerk magnitude profiles in the complex 2D environment.
Sensors 25 05598 g014
Figure 15. Velocity, acceleration, and jerk magnitude profiles in the simple 3D environment.
Figure 15. Velocity, acceleration, and jerk magnitude profiles in the simple 3D environment.
Sensors 25 05598 g015
Figure 16. Velocity, acceleration, and jerk magnitude profiles in the complex 3D environment.
Figure 16. Velocity, acceleration, and jerk magnitude profiles in the complex 3D environment.
Sensors 25 05598 g016
Table 1. Parameter settings of each algorithm.
Table 1. Parameter settings of each algorithm.
Algorithm d step Iter N rewire D obs d λ p bias
Bi-RRT*5 (2D) / 7 (3D)150010
Bias-P-RRT*5 (2D) / 7 (3D)150010 1 2 d step 1 4 d step 0.2
KSBB-P-RRT* γ -adaptive ( γ = 15 )150010 1 2 d step 1 4 d step [0, 0.6]
Table 2. Performance comparison of three RRT-based algorithms across four benchmark environments based on 100 experimental runs per case.
Table 2. Performance comparison of three RRT-based algorithms across four benchmark environments based on 100 experimental runs per case.
EnvironmentAlgorithm T avg (s) C avg I avg I max
Simple 2DBi-RRT*0.338151.109107.49224
Bias-P-RRT*0.497146.665172.20430
KSBB-P-RRT*0.213146.02927.0297
Complex 2DBi-RRT*0.994145.483154.74408
Bias-P-RRT*0.816140.063153.22304
KSBB-P-RRT*0.663136.15361.74252
Simple 3DBi-RRT*0.524210.003297.211323
Bias-P-RRT*1.449194.280229.72821
KSBB-P-RRT*0.231192.97615.8428
Complex 3DBi-RRT*2.276189.66859.59140
Bias-P-RRT*2.084179.05155.96291
KSBB-P-RRT*0.675177.7678.5916
Table 3. Average path costs at three optimization phases for four benchmark environments based on 100 experimental runs per case.
Table 3. Average path costs at three optimization phases for four benchmark environments based on 100 experimental runs per case.
Environment C init C opt C smooth
Simple 2D156.912150.246146.029
Complex 2D143.925138.874136.153
Simple 3D210.115195.515192.976
Complex 3D187.065177.960177.767
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

Liu, H.; Li, Y.; Yang, Z.; Shen, Y. Fast Path Planning for Kinematic Smoothing of Robotic Manipulator Motion. Sensors 2025, 25, 5598. https://doi.org/10.3390/s25175598

AMA Style

Liu H, Li Y, Yang Z, Shen Y. Fast Path Planning for Kinematic Smoothing of Robotic Manipulator Motion. Sensors. 2025; 25(17):5598. https://doi.org/10.3390/s25175598

Chicago/Turabian Style

Liu, Hui, Yunfan Li, Zhaofeng Yang, and Yue Shen. 2025. "Fast Path Planning for Kinematic Smoothing of Robotic Manipulator Motion" Sensors 25, no. 17: 5598. https://doi.org/10.3390/s25175598

APA Style

Liu, H., Li, Y., Yang, Z., & Shen, Y. (2025). Fast Path Planning for Kinematic Smoothing of Robotic Manipulator Motion. Sensors, 25(17), 5598. https://doi.org/10.3390/s25175598

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