Next Article in Journal
An Explainable YOLO-Based Deep Learning Framework for Pneumonia Detection from Chest X-Ray Images
Previous Article in Journal
Explainable Schizophrenia Classification from rs-fMRI Using SwiFT and TransLRP
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

An Improved Bi-RRT Algorithm for Optimal Puncture Path Planning

School of Automation, Guangxi University of Science and Technology, Liuzhou 545006, China
*
Author to whom correspondence should be addressed.
Algorithms 2025, 18(11), 702; https://doi.org/10.3390/a18110702
Submission received: 14 August 2025 / Revised: 23 October 2025 / Accepted: 30 October 2025 / Published: 4 November 2025
(This article belongs to the Section Combinatorial Optimization, Graph, and Network Algorithms)

Abstract

Percutaneous puncture has become one of the most widely used minimally invasive techniques in clinical practice due to its advantages of low trauma, quick recovery and easy operation. However, incomplete needle tip movement, tissue barriers and complex distribution of sensitive organs make it difficult to balance puncture accuracy and safety. To this end, this paper proposes a new puncture path planning algorithm for flexible needles, which integrates gravitational guidance, bi-directional adaptive expansion, optimal node selection based on the A* algorithm, and path optimization strategies, with Bi-Rapid-Research Random Trees (Bi-RRTs) at its core, to significantly improve obstacle avoidance capability and computational efficiency. The simulation results of 2D and 3D complex scenes in MATLAB show that compared with the traditional RRT algorithm and Bi-RRT algorithm, the GBOPBi-RRT algorithm achieves significant advantages in terms of path length, computation time and node size. In particular, in the 3D environment, the GBOPBi-RRT algorithm shortens the planning path by 43.21% compared with RRT, 27.47% compared with RRT* and 30.33% compared with Bi-RRT, which provides a reliable solution for efficient planning of percutaneous puncture with flexible needles.

1. Introduction

With good flexibility, obstacle avoidance ability, high dexterity and variable curvature, the trocar flexible needle can avoid some obstacles like bones or blood vessels to realize the targeted puncture of the lesion. Compared with rigid needles, the form of the puncture path of cannulated flexible needles is particularly complicated. Therefore, it is necessary to conduct a more in-depth study on the path planning algorithm for flexible cannulated needles. The path planning solution algorithms for flexible needles can be broadly categorized into mathematical algorithms, inverse kinematics algorithms, intelligent algorithms and search algorithms [1,2,3].
The numerical method can simplify the complex path planning problem into a mathematical problem by establishing and calculating an optimization function to find the optimal solution of the path [4]. The algorithm can obtain global or local optimal solutions, but its solutions are often affected by the initial settings and suffer from slow computation speed and mathematical non-convergence.
In 2005, Alterovitz et al. [5] proposed a puncture path planning algorithm for flexible needles in conjunction with a single-wheel kinematic model, which discretizes the state space of the needle tip position and orientation by using a Markov decision process to compute the optimal steering point that maximizes the probability of the flexible needle tip reaching the target, and gives Bellman’s equation for the stochastic shortest path. In 2007, Alterovitz et al. [6] proposed a stochastic motion wayfinding algorithm based on the previous theory. The algorithm can plan the motion trajectory of a flexible needle under uncertain image navigation conditions.
A search method involves randomly selecting points in the state space and then connecting the appropriate sampled points in some way to create paths. There are three typical search methods: the Artificial Potential Field (APF) method, the Probabilistic Roadmap (PRM) algorithm, and the Rapid Exploration Random Tree (RRT) algorithm. A* and RRT algorithms are among the more typical search algorithms. Many hybrid algorithms based on A* utilize metaheuristic techniques, such as the multiagent hybrid clustering-assisted genetic algorithm (MA-HCAGA) and the A*-PSO hybrid algorithm. The MA-HCAGA algorithm was proposed by Andranik S. Akopov et al. [7] This algorithm, by integrating multi-agent systems, fuzzy clustering, genetic operators, and particle swarm mechanisms, demonstrates superior Pareto front quality in bi-objective optimization. However, it faces challenges such as random evolution failing to guarantee a global optimum, sensitivity to key frequency parameters, and slow convergence due to improper parameter tuning. The APSO algorithm, proposed by Huang et al. [8] in 2023, combines A* with an improved PSO, eliminating redundant nodes and introducing random inertia weights and reverse learning. It offers advantages such as fast search, smooth paths, and short runtime. However, its drawbacks include relatively high algorithm complexity and the inability to theoretically guarantee a global optimal path due to random initialization and the evolutionary mechanism. The RRT algorithm was proposed by Edsger Wybe Dijkstra [9,10]. the advantages of the search method are easy convergence and fast search, its disadvantage is that the nature of random sampling makes it possible to find feasible paths without ensuring the best route.
Bidirectional RRT (Bi-RRT) reduces the search time by more than 30% in complex environments by simultaneously growing two trees from the starting point and the goal point, but it still follows the stochastic expansion mechanism without goal bias, and the problems of redundant nodes and tortuous paths are still prominent [11]. In 2025, Huang Bo et al. [12] introduced a hierarchical sampling strategy within the Bi-RRT framework, which significantly improved the path smoothing, but accompanied by a surge in computation and a decrease in real-time performance instead.
Aiming at the problems of the traditional bidirectional rapidly expanding random tree (Bi-RRT) in flexible needle puncture path planning, this paper proposes an improved Bi-RRT algorithm for flexible needle puncture, which aims to improve the efficiency and quality of flexible needle path planning.The GBOPBi-RRT algorithm reduces the blindness of the search, improves the convergence speed, eliminates the redundant nodes, reduces the path length, and improves the search efficiency and effectiveness by introducing the gravitationally oriented, bi-directionally adaptive expansion, the optimal node selection based on the A* algorithm and the path optimization strategy.

2. Related Work

2.1. Two-Dimensional Puncture Path Planning

Addressing the multiple challenges posed by flexible needles in soft tissue—including susceptibility to deformation, high real-time requirements, and the need to balance puncture accuracy with damage control, in 2012, Zhao et al. [13] pioneered a flexible needle path planning method. By simultaneously optimizing the entry point, needle posture, and manipulation parameters based on an improved loop model, they significantly improved puncture performance. Addressing the challenge of balancing multiple objectives (real-time performance, accuracy, and tissue damage) that are difficult to balance online, Bobrenkov et al. and Huo et al. developed a multi-objective optimization framework, achieving high-fidelity online planning [14,15]. Addressing the issues of blind sampling and single evaluation dimension in complex soft tissue environments with traditional RRT, in 2017, Li et al. [16] improved the RRT algorithm based on environmental features, redefined the path evaluation function, and assigned weights based on obstacle risk levels, while comprehensively considering multiple indicators such as path length, arc segment count, and safety. To address the challenges of low initial path quality and optimization getting stuck in local optima during the iterative learning process of flexible needle trajectories, in 2021, Li et al. [17] proposed an iterative learning trajectory planning algorithm: first generate an initial path set in rigid body space, then select the optimal path using a genetic-simulated annealing hybrid optimization method. To address the issue of large prediction errors caused by the heterogeneity of soft tissue affecting the trajectory of flexible needles, in 2022, Xiong et al. [18] and other researchers combined the Fokker–Planck equation with an analytical Kriging model to predict the trajectory of flexible needles, and further improved prediction accuracy through data-driven post-processing.
However, the traditional RRT and Bi-RRT still have obvious shortcomings, random sampling makes the path tortuous and redundant, especially in the narrow space; although Bi-RRT is bi-directionally parallel, the proportion of invalid sampling is still high; and both lack cost function guidance. To this end, this paper proposes the GBOPBi-RRT algorithm, which uses the target gravitational field potential function to guide the sampling and increase the effective sampling rate; then uses the adaptive step size to avoid obstacles, so that the number of iterations can be effectively reduced; introduces the cost function based on the A* algorithm to optimize nodes in the bi-directional tree connecting phase, so as to reduce the cost of the path; and finally, through the pruning of the redundant nodes to shorten the length of the path to achieve the simultaneous improvement in real-time performance and optimality [19,20].

2.2. Three-Dimensional Puncture Path Planning

Puncture accuracy is affected by a variety of factors, such as needle–tissue interaction, patient movement and physiological changes. In recent years, dynamic path planning has attracted much attention because it is more compatible with human physiology and has more advantages over static planning.
Wang et al. [21] proposed a dynamic path planning and tracking control method based on curve fitting for needle insertion. They constructed a three-dimensional needle–tissue interaction deformation model using the local constraint method, which can simultaneously predict the needle–tissue interaction force and the needle–tissue deformation. Based on this model, the targeting error due to tissue deformation and needle deflection is corrected by iterative learning control, and the results show that the method can significantly improve the accuracy of needle tip localization.
Lei et al. [22] proposed a needle puncture path planning method based on a needle–tissue interaction model and designed a patient-specific parameter identification algorithm. They first used a fast exploratory random tree algorithm to generate static paths, then applied a complete computational model to calculate the forces and deformations of the static paths, and proposed an intraoperative patient-specific parameter identification algorithm to identify patient-specific parameters. Simulation experiment results show that the method can reduce the targeting error from a maximum of 3.89 mm to less than 1 mm.

3. Method Construction

In recent years, flexible needle path planning techniques based on RRT (Rapidly-exploring Random Tree) algorithm have received much attention. As an important improvement, Bi-RRT (Bidirectional rapidly-exploring random tree) algorithm has made significant progress in improving the efficiency of path planning [23]. However, the traditional Bi-RRT algorithm lacks a clear goal orientation during the random tree growth process, leading to the generation of a large number of redundant nodes, which not only significantly reduces the search efficiency, but also increases the computational cost, limiting its application in complex environments. In order to overcome this limitation of the traditional Bi-RRT algorithm, an improved GBOPBi-RRT algorithm is proposed in this paper. The algorithm significantly improves the efficiency of path planning and path quality by introducing the optimal node selection strategy of the gravity-oriented strategy, the bidirectional adaptive step-size strategy, the optimal node selection strategy based on A* heuristic algorithm, and the path optimization technique. Due to the fact that the path generated by the flexible needle within the tissue is an arc-shaped path with a variable radius and is affected by the material and curvature characteristics of the flexible needle, it may lead to the planned path being unreachable. Therefore, it is necessary to conduct kinematic modeling and reachable space analysis of the flexible needle puncture process and correct the unreachable paths. The overall system architecture is illustrated in Figure 1.
In Figure 1, the puncture path is first obtained through simulation and subsequently validated by physical experiments. The puncture experiments are carried out by mounting a puncture execution mechanism—with two degrees of freedom (rotation and feed)—at the end effector of a dual-arm robot and applying a duty-cycle control strategy. The Fiber Bragg Grating (FBG) sensor offers advantages such as high sensitivity, fast response, and good compatibility; therefore, it was selected for this design. Three optical fibers were used, arranged at 120 ° intervals. Triangular grooves were created, and the fibers were embedded within them to form the core structure of the flexible needle. Based on the FBG sensing principle, the wavelength information is transmitted to the host computer via an FBG demodulator (model MOI si155) for real-time perception of the flexible needle’s shape and tip position, providing closed-loop feedback for the puncture robot’s path planning and puncture control. The sensor features a wavelength resolution of 1 pm , a strain resolution of 1.2 μ ε , and a spatial resolution of 30 mm , with an expected shape reconstruction accuracy at the sub-millimeter level. Regarding the puncture execution mechanism, the feed unit employs a two-phase stepper motor with a step angle of 1.8 ° , driving the needle tube axially via a 0601 ball screw pair. The rotation unit utilizes a brushless DC motor (BLDC) controlled by field-oriented control (FOC) and is equipped with a 12-bit absolute encoder (resolution: 4096 counts/rev). After integration with the UR3 robotic arm, the actuator achieves an end-effector positioning accuracy within 0.1 mm . The current and velocity control loops can operate at high frequency, and considering the mechanical inertia and resonance of the screw, coupler, and needle, the system bandwidth reaches 20– 50 Hz . The core contribution of this work lies in planning a puncture trajectory through simulation that conforms to the material characteristics of the flexible needle in a simulated puncture environment.

3.1. Brief Description of Bi-RRT Algorithm

The algorithm abandons the traditional completely randomized expansion method and adopts the greedy expansion idea instead. Given that the start point and the target point are both in the restricted space surrounded by obstacles, this heuristic expansion strategy can effectively motivate the two search trees to grow with each other quickly, so that they can quickly get rid of their respective constraint space limitations, thus significantly shortening the convergence time of the algorithm and improving the overall efficiency. The extension process of the Bi-RRT algorithm is shown in Figure 2.
In Figure 2, the left side shows the random tree T a , while the right side shows the random tree T b . In the random tree T a , Pinit denotes the starting point of the path planning. P r a n d is the random sampling point, and P n e a r is the node with the closest distance to P r a n d in the random tree T a . and P n e w is the new node that is generated by expanding along the fixed search step from P n e a r . In the random tree T b , P n e a r is the node with the closest distance to P n e w , while P n e w is a new node generated by expanding along a fixed search step from P n e a r .

3.2. Improved Bi-RRT Method: GBOPBi-RRT

3.2.1. Gravity-Oriented Strategy

The artificial potential field method is a path planning method based on virtual force field, which belongs to the category of local path planning. Its core idea is to equate the motion environment where the flexible needle is located to a virtual artificial potential field [24]. In the field of path planning, the artificial potential field method can provide heuristic information for the Bi-RRT algorithm, thus effectively guiding its exploration process. In this way, Bi-RRT algorithm can traverse the nodes more intelligently and choose the exploration direction, thus significantly improving the speed of path search and finding the global optimal path faster. At the same time, the Bi-RRT algorithm can provide strong support for the artificial potential field method by virtue of its fast searching characteristics, helping it to overcome the dilemma of local minima, thus significantly improving the robustness of the path planning algorithm.
In the traditional Bi-RRT algorithm, the expansion process of the random tree has a high degree of randomness, which leads to low search efficiency, especially in complex environments where the problem of blind search is prone to occur. In order to improve the search efficiency and goal orientation of the algorithm, this paper introduces the gravitational orientation strategy, which guides the growth direction of the random tree to approach the goal point more quickly by simulating the action of the gravitational field, as shown in Figure 3.
In Figure 3, the dots indicate the nodes of the Bi-RRT tree. Take one of the trees as an example, its start point is the root node. Suppose the start point is P i n i t , the target point is P g o a l , and the direction pointed by the arrow is the direction of the force. During the spatial search, the random tree generates a random point P r a n d , and then it expands at the closest node P n e a r to P r a n d in the direction from P n e a r to P r a n d in steps of fixed length s to generate a new node P n e w .
The design of the gravitational field function is inspired by the artificial potential field method, and its core idea is to direct the growth direction of the random tree by applying a gravitational-like effect of the target point on the random tree growth process [25,26]. Specifically, for the current node P n e a r on the random tree, its gravitational force H a t t ( P ) from the target point P g o a l can be expressed as:
H a t t ( P ) = s · λ · P g o a l P n e a r P g o a l P n e a r
where: s is the extension step size, which controls the distance of each node extension; λ is the gravitational coefficient, which is used to adjust the magnitude of the gravitational force; P g o a l P n e a r is the direction vector pointing from the current node to the target point; ∥ P g o a l P n e a r ∥ is the Euclidean distance between the current node and the target point, which is used to normalize the gravitational direction vector.
In each expansion of the random tree, the original expansion direction vector R ( P ) is first computed from the random sampling point P r a n d and the nearest node P n e a r :
R ( P ) = s · P r a n d P n e a r P r a n d P n e a r
The gravitational H a t t ( P ) is then superimposed with the original extended direction vector R ( P ) to obtain the final extended direction vector H f i n a l ( P ) :
H f i n a l ( P ) = H a t t ( P ) + R ( P )
Eventually, the position of the new node P n e w can be calculated by the following equation:
P n e w = P n e a r + H f i n a l ( P )
By introducing the gravity-oriented strategy, the growth direction of the random tree is influenced by the gravitational force of the target point, which enables the random tree to expand toward the target point more efficiently, reduces the blindness during the search process, and improves the search efficiency of the algorithm and the success rate of path planning.
The size of the gravitational coefficient λ has an important effect on the growth direction and search efficiency of the random tree [27]. When λ is large, the random tree is subject to stronger gravitational force, and the growth direction is more inclined to point directly to the target point, which helps to approach the target point quickly, but may lead to the random tree’s search range near the target point is too narrow, and is easy to fall into the local optimum. On the contrary, when λ is small, the growth direction of the random tree is more flexible and can search in a wider range, which is conducive to avoiding obstacles, but may increase the search time. Therefore, in practical applications, the size of the gravitational coefficient λ needs to be reasonably adjusted according to the complexity of the environment and the specific requirements of path planning, in order to achieve the best search effect.

3.2.2. Bidirectional Adaptive Scaling Strategy

In the traditional two-way fast exploration randomized tree algorithm, the expansion step size of nodes is usually fixed. This fixed step-size strategy has certain limitations in complex environments. When the search space is large, a larger step-size can accelerate the search speed, but it may lead to an insufficiently smooth path; meanwhile, when approaching the target point or the dense region of obstacles, a smaller step-size can improve the smoothness and safety of the path, but it will significantly increase the search time. Compared with the fixed step size, the dynamic step size can fully exploit and utilize the known environmental information to adjust the current extended step size to a more appropriate size, thus realizing a more efficient and adaptive optimization process [28]. In order to overcome these shortcomings, this paper proposes an adaptive expansion strategy that dynamically adjusts the step length according to the distance between the current node and the target point.
The core of the adaptive expansion strategy lies in dynamically adjusting the step size according to the distance between the current node and the target point. Specifically, for each node of the forward and reverse trees, the expansion step size s is defined as:
s = max s min , min s max , d c
where: s min and s max are the minimum and maximum values of the step size, respectively, which are used to limit the range of the step size; d is the Euclidean distance between the current node and the target point; c is the number of nodes in the current tree, which is used to dynamically adjust the size of the step size.
When the search space is large, the distance d between the current node and the target point is large, so the step size s approaches s max . This allows the search tree to expand quickly towards the target point and speeds up the search. As the search tree is being formed, the distance d between the current node and the target gradually decreases, while the number of nodes c increases. At this time, the step size s will be dynamically adjusted according to d c , which not only ensures the search efficiency, but also avoids the path being too rough. When the search space is small, the step size s approaches s min . This enables the search tree to perform fine search when approaching the target point or dense obstacle area, and improves the smoothness and safety of the path.

3.2.3. Optimal Node Selection Based on A* Algorithm

In the expansion process of the bidirectional random tree, the selection of the nearest node P n e a r plays a crucial role in the generation of the new node P n e w . Specifically, the nearest node P n e a r is selected by calculating the Euclidean distance between each node P i ( x i , y i ) in the random tree T a and the new random point P n e w ( x j , y j ) generated based on the direction of the ensemble force; however, this Euclidean distance-based selection makes the random tree T a significantly more dependent on the new random point P n e w . A potential problem is that the selected nearest node P n e a r is not necessarily the optimal node from a global path planning perspective, which may impose some limitations on the optimization of the path. Euclidean distance is:
l = x i x j 2 + y i y j 2
in the above equation, i denotes the node index in the random tree T a and its value range is [1, length( T a )], where length( T a ) denotes the total number of nodes in the random tree T a .
After generating a new node P n e w by the bi-directional adaptive expansion strategy, the idea of cost estimation in the A* algorithm is introduced, and a heuristic method is used to select the node with the smallest cost in the random tree T a as the nearest node P n e a r . This improvement enables the bidirectional random tree to expand the path towards the goal more efficiently. The cost estimation function of the A* algorithm is:
G ( n ) = g ( n ) + h ( n )
where g ( n ) is the actual cost from each point P i on the random tree T a to the new random point P n e w ; h ( n ) is the estimated cost from P i to the target point P g o a l . Where the actual cost is the cumulative path length from the starting point to P i and the estimated cost is the Euclidean distance from P i to the goal point.
By introducing the optimal node selection strategy based on the A* algorithm, the improved Bi-RRT algorithm pays more attention to goal orientation in the path planning process, which can effectively reduce the path length and planning time and improve the efficiency and quality of path planning.

3.2.4. Path Optimization Strategy

In the bidirectional fast expanding random tree algorithm, the generated path usually contains a large number of redundant nodes, resulting in a jagged path, which not only increases the path length, but also reduces the smoothness of the path and the efficiency of the motion of the flexible needle. In order to improve the quality of the path, this paper proposes a path optimization strategy, by pruning and interpolating the redundant nodes of the generated path to smooth the path, so that the path is more concise and smooth, which is closer to the kinematics of flexible needle puncture. The pruning process is shown in Figure 4, where the black dotted lines represent the original path, clearly depicting the initial traveling trajectory. The green lines, on the other hand, mark the regions in the path that are at risk of collision. After optimization, the final red solid path is obtained, which is a safe and efficient path after trimming and adjustment.
Starting from the beginning of the path, each node is traversed along the path sequentially. For the current node and its subsequent nodes, check whether the connecting line between the two has collided with an obstacle. If the connecting line between the current node and the subsequent node has no collision, all intermediate nodes between the current node and the subsequent node are deleted; if a collision is detected, the previous node of the subsequent node is retained and the checking of the subsequent nodes continues.

3.2.5. Algorithms Run Pseudo-Code

Based on the preceding theoretical framework, the enhanced Bi-RRT algorithm is employed to efficiently plan the puncture path, as outlined in the pseudocode below.
Algorithm 1 describes the proposed GBOPBi-RRT algorithm, developed based on the following principles.
  • (Lines 1–3) Initialize the forward tree T forward rooted at P init and the backward tree T backward rooted at P goal . Set the algorithm parameters η min , η max , k gravity , and M a x I t e r , and set the expansion direction flag forward_to_backward to true.
  • (Lines 4 and 5) Randomly sample a point P rand within the search space at each iteration to guide the bidirectional expansion.
  • (Line 6) Select the optimal node P near in the current tree using an A*-inspired cost function that balances exploration efficiency and convergence toward the goal.
  • (Lines 7–10) Compute an adaptive step size based on the distance between P near and the goal. Determine the expansion direction by combining the random sampling direction with a gravity term that biases the search toward the goal. Generate a new node P new from P near along this direction.
  • (Lines 11 and 12) If the segment between P near and P new is collision-free, add P new to the current tree as a child of P near ; otherwise, skip to the next iteration.
  • (Lines 13–17) Check whether the newly expanded node can connect the two trees. If a valid connection is found, reconstruct the complete path by merging the forward and backward trees, and terminate the loop. Alternate the expansion direction after each iteration to ensure balanced bidirectional growth.
  • (Lines 19 and 20) Optimize the resulting path to remove redundant nodes and improve trajectory continuity. Return the optimized path P a t h opt as the final output.
Algorithm 1 GBOPBi-RRT( P init , P goal , Path)
1:
Initialize T forward { P init } , T backward { P goal }
2:
Set η min , η max , k gravity , Maxiter
3:
f o r w a r d _ t o _ b a c k w a r d true
4:
for iter = 1 : Maxiter do
5:
P rand RandomSample(Map)
6:
P near a r g m i n ( cos t ( V i ) = d i s t ( V i , r o o t ) + α · d i s t ( V i , g o a l ) )
7:
S clamp d i s t ( P near , g o a l ) | T current | , η min , η max
8:
g r a v i t y D i r n o r m a l i z e ( g o a l P near )
9:
e x p a n d D i r n o r m a l i z e ( ( P rand P near ) + k gravity · g r a v i t y D i r )
10:
P new P near + S · e x p a n d D i r
11:
if not CollisionFree( P near , P new ) then continue
12:
 AddNode( T current , P new , P near )
13:
if Connectable( T forward , T backward , P new , S) then
14:
  Path ← Reconstruct( T forward , T backward )
15:
  break
16:
end if
17:
f o r w a r d _ t o _ b a c k w a r d ¬ f o r w a r d _ t o _ b a c k w a r d
18:
end for
19:
P a t h opt OptimizePath(Path)
20:
return P a t h opt

3.3. Puncture Path Analysis

3.3.1. Unicycle Kinematic Model

Flexible needles with asymmetric beveled tips are highly flexible. During puncture, the needle axis bends in the direction of the beveled tip due to the reaction forces generated by the soft tissue, thus creating a circular path of variable radius inside the tissue. The puncturing principle of flexible needles is very different from that of conventional rigid needles. Flexible needles are controlled by two degrees of freedom: a feed motion that includes forward and backward movement of the needle and a rotary motion that changes the direction of bending, which can be compared to the motion of a bicycle [29,30] and can be simplified as a one-way valve.
In this paper, a uniaxial puncture kinematic model is developed, as shown in Figure 5, in which the fixed inertial reference system AXYZ and the follower coordinate systems A1Y1Z1 and A2Y2Z2, which are solidly attached to the tip of the needle, are defined. In the needle body coordinate system, the Z1-axis is along the direction of needle body insertion, and the Y1-axis is perpendicular to the Z1-axis and in the direction opposite to the direction of needle body bending [31]. During the puncture process, the needle body produces a compound motion under the effect of tissue interaction force, including translational motion with velocity along the Z1-axis and rotational motion with angular velocity ω around the X1-axis, and the relationship between linear velocity v and angular velocity ω can be expressed as:
ω = v r 1
where r 1 represent the radius of penetration determined by the mechanical properties of the needle. Equation (1) clearly shows that the trajectory of the flexible needle is a circular path with radius r 1 . According to the relevant literature, the trajectory of the needle is jointly determined by the feed motion and the rotational motion of the needle, and the velocities of these two motions are denoted by u 1 and u 2, respectively [32,33,34]. Therefore, v and ω can be expressed as:
v = [ 0 0 u 1 ] T
ω = u 1 r 1 0 u 2 T
The kinematic trajectory function and the kinematic model can be expressed as:
G = f ( r , u 1 , u 2 )
q = v ω = 0 0 u 1 u 1 r 1 0 u 2
where r 1 can be the radius of the first segment of the circular trajectory of the flexible needle into the tissue and q is the state of motion of the needle during the movement of the flexible needle. The coordinate transformation matrix B W F from the flexible needle coordinate system to the world coordinate system is described as:
B W F = R W F X W F 0 1 SE ( 3 )
SE ( 3 ) = R 3 × SO ( 3 )
where B W F ∈ SO (3) (SO (3) denotes the three-dimensional rotation group) and X W F R 3 denote the rotation matrix and the position vector of the coordinate system A1 with respect to the coordinate system A2, respectively. Moreover, SE (3) denotes the special Euclidean group, also known as the rigid body transformation group. Thus, the motion of the needle tip can be described as follows:
P = v ω = 0 u 2 r 2 0 0 u 2 0 u 1 r 1 0 0 u 1 r 1 0 u 1 0 0 0 0
where ∧ is the wedge operator for generating matrices in the special Euclidean group SE (3) and r 2 represent the radius of penetration determined by varying the ratio of the angle of rotation of the needle to the depth of penetration. And the term SE (3) is the Lie algebra expression of SE (3), which in a physical sense represents the generalized instantaneous velocity. The chi-square transformation matrix can be represented by means of an exponential mapping in the following form:
B W F ( t ) = B W F ( 0 ) exp q t
In Equation (9), B W F (0) denotes the initial configuration of the flexible needle, i.e., the starting position and orientation of the needle tip in 3D space. t denotes the time, which represents the motion state of the needle tip after a time t from the initial configuration. This time t, together with q, is used to calculate the position and orientation of the needle at time t by the exponential form exp(qt). Equation (9) is an element of the Lie algebra expression of SE (3) that describes rigid-body transformation, i.e., translation and rotation of a rigid body.

3.3.2. Reachable Space Analysis for Flexible Needles

During flexible needle puncture, the interaction between the needle and tissue causes the puncture path to be strongly influenced by the needle’s material properties and intrinsic curvature. Consequently, the planned path may not be achievable due to limited spatial accessibility. Therefore, path planning must consider the actual reachable workspace of the flexible needle and optimize inaccessible regions to ensure path smoothness, safety, accessibility, and optimality (i.e., minimal length). Owing to its structural characteristics, the flexible needle exhibits a maximum and minimum spatial bending radius, r m a x and r m i n , respectively, as shown in Figure 6. To guarantee path accessibility, the bending radius between any two consecutive puncture points, r i , must satisfy the following constraint:
r m i n r i r m a x
The emergence of unreachable paths is an urgent problem in flexible needle puncture path planning. In order to solve this problem, this paper proposes a puncture path optimization function, through which the path is corrected to effectively guarantee the accessibility of flexible needle puncture. The optimization function integrally considers key factors such as the bending curvature characteristics of the flexible needle, the degree of damage to the tissue by the flexible needle and the safety level of the puncture path, aiming to achieve the science and safety of path planning. The following is the definition of the optimization function:
P O F min = min k 1 L + k 2 D + k 3 C
where k 1 , k 2 and k 3 denote the weight coefficients of the corresponding subfunctions, respectively, which are used to balance the influence of each factor on the path planning; L denotes the total length of the puncture path; D denotes the shortest distance between the tip point of the needle and the obstacle; and C denotes the degree of bending of the flexible needle in the tissues. By adopting the flexible needle characterization strategy, a significant improvement in the performance of path planning is achieved. These improvements make the puncture path of the flexible needle more closely match the real puncture environment, thus ensuring that the flexible needle can reach the target position safely and reliably.

4. Results

4.1. Simulation Results of Flexible Needle Two-Dimensional Path Planning

In order to verify the rationality and feasibility of the improved algorithm in this paper, a series of comparative simulation experiments are designed and implemented. The experimental platform is MATLAB R2022b, the hardware configuration is AMD Ryzen 9 8940HX with Radeon Graphics CPU, 8 GB RAM, and the operating system is 64-bit Windows 11. Considering the effect of randomness on the results, each algorithm is run independently for 20 times under the same experimental environment, so as to ensure the reliability of the conclusions by the statistical mean value. The reliability of the conclusions is guaranteed by the statistical mean value. Simulation studies were first performed in the first two-dimensional environment, the simulation scenario is set as an 800 × 800 square area: the starting point is located in the lower right corner (500, 700) and the target point is placed in the upper left corner (50, 50). The multi-obstacle environment consists of three circular obstacles with centroid coordinates (150, 550), (375, 425), and (550, 200), and corresponding radii of 60, 90, and 70, respectively. Subsequently, simulation studies were conducted in the second two-dimensional environment, the simulation scenario is set as an 800 × 800 square area: the starting point is located in the upper left corner (1, 1) and the target point is placed in the lower right corner (750, 750). The multi-obstacle environment consists of five circular obstacles with centroid coordinates (200, 200), (300, 600), (400, 400), (600, 300), and (600, 600), and corresponding radii of 50, 60, 80, 40, and 30, respectively. For all four comparison algorithms, the goal threshold was set to 30, and the maximum number of search iterations was limited to 3000. In the proposed improved algorithm, the maximum and minimum expansion step sizes were set to 40 and 25, respectively, while the expansion step size for the other algorithms was fixed at 32.5. The connection threshold between the two search trees was set to 40. And the radius of each obstacle is uniformly doubled to simulate the possible localization bias in the puncture process and to ensure safety. The radius of each obstacle is uniformly doubled to simulate possible positioning deviations during puncture and to ensure safety. This diagonal start-end layout can comprehensively test the algorithm’s ability to search and avoid obstacles in any direction, and at the same time facilitates a visual comparison of the smoothness and length of the paths obtained by different algorithms. This standardized environment not only ensures the fairness of the algorithm evaluation, but also provides a reliable experimental basis for the further optimization of the algorithm.
The RRT, RRT*, Bi-RRT, and the proposed improved algorithms were each evaluated through 20 repeated simulations in two distinct environments, with all resulting data recorded and analyzed. The path planning outcomes of the four algorithms in the two simulated map environments are illustrated in Figure 7 and Figure 8.
In the path expansion process, the traditional RRT algorithm lacks directionality due to random sampling, and the search tree is in the form of “unordered spreading”, with serious branch redundancy, which leads to low node utilization and significant iteration time; building upon the RRT framework, the RRT* algorithm introduces a rewiring and path optimization mechanism to achieve asymptotic optimality. However, it still relies on global random sampling, which can lead to invalid extensions and inefficient rewiring in simulation environments, resulting in slow convergence and high computational cost; the standard Bi-RRT algorithm mitigates the problem of slow convergence through bidirectional parallel expansion, but the two trees still rely on purely random sampling, and are prone to form “cross-redundant branches” in the obstacle-dense region, as shown in Figure 7a–d and Figure 8a–d. The GBOPBi-RRT algorithm proposed in this paper embeds an artificial potential field guidance mechanism in the traditional Bi-RRT framework, and through the synergistic effect of the target gravitational force and the starting point retrospective force, the random sampling direction is modified to the direction of the combined force of the target and the random guidance, which significantly compresses the ineffective search space; and adopts a dynamic step-size strategy, which is based on the current node density and the target distance to adapt to the current node density and the target distance. Dynamic step size strategy is adopted to adaptively adjust the expansion step size according to the current node density and target distance to avoid over-branching; combined with the A* heuristic cost function to optimize the selection of nearest-neighbor nodes, the expansion efficiency is improved.
In order to more intuitively and fully verify the reasonableness and superiority of GBOPBi-RRT algorithm with the introduction of smooth fitting, we designed 40 sets of comparison experiments in the simulation environment and systematically collected four key indexes, namely, path length, running time, node size and iteration number. Figure 9a–d show the quantitative comparison results between GBOPBi-RRT and the other three mainstream algorithms in the above dimensions.
Table 1 presents the comparative results of the average values for four metrics—path length, computation time, number of generated nodes, and number of iterations—obtained from 40 independent experiments conducted in two different environments using the RRT, RRT*, Bi-RRT, and the proposed GBOPBi-RRT algorithms.
As shown in Table 1 and Figure 7 and Figure 8a–e, the GBOPBi-RRT algorithm demonstrates significantly better performance in terms of path length and planning time compared with the other algorithms in both circular environments. Compared with RRT, the path length is shortened by 25.09%, the planning time is shortened by 87.67%, and the number of nodes and iterations are reduced by 88% and 75.89%, respectively; compared with RRT*, the path length is shortened by 14.64%, the planning time is shortened by 67.11%, and the number of nodes and iterations are reduced by 87.5% and 74.35%, respectively; compared with Bi-RRT, the path length and planning time are reduced by 23.27% and 36.97%, respectively, and the number of nodes decreases by 40%, but the number of iterations increases by 14.89%. Comprehensively, GBOPBi-RRT achieves significant improvement in path quality, planning efficiency and node utilization compared with traditional RRT and Bi-RRT in both circular scenarios.

4.2. Simulation Results of Flexible Needle Three-Dimensional Path Planning

In order to further verify the feasibility of GBOPBi-RRT in 3D complex scenes, this paper carries out comparative simulation experiments in a 100 × 100 × 100 cube space (x, y, z ∈ [0, 100]). Simulation studies were first performed in the first three-dimensional environment, a total of 10 spherical obstacles are arranged in the environment, and the coordinates of the spherical centers are (67, 89, 47), (35, 83, 84), (54, 58, 78), (81, 17, 68), (80, 72, 41), (77, 71, 79), (24, 85, 40), (40, 73, 74), (74, 69, 10) and (50, 50, 50), and the radii are all 10. The radius is 10. The starting point is (5, 5, 5) and the target point is (95, 95, 95). Subsequently, simulation studies were conducted in the second three-dimensional environment, a total of 10 spherical obstacles are arranged in the environment, and the coordinates of the spherical centers are (70, 30, 50), (80, 10, 70), (20, 90, 65), (40, 40, 40), (60, 60, 60), (20, 10, 70), (30, 50, 50), (20, 20, 70), (41, 79, 40) and (74, 10, 50), and the radii are all 10. The radius is 10. The starting point is (10, 90, 90) and the target point is (75, 10, 10). For all four comparison algorithms, the goal threshold was set to 8, and the maximum number of search iterations was limited to 1000. In the proposed improved algorithm, the maximum and minimum expansion step sizes were set to 5 and 25, respectively, while the expansion step size for the other algorithms was fixed at 15. The connection threshold between the two search trees was set to 8. Typical simulation results in a 3D scenario are shown in Figure 10 and Figure 11.
In order to eliminate the bias caused by random fluctuations, in this study, the GBOPBi-RRT algorithm and three mainstream algorithms were each independently executed 20 times under identical conditions in two three-dimensional scenarios and this paper compares them in four dimensions, namely, path length, running time, number of nodes, and number of iterations, and the statistical results are shown in Figure 12a–d.
Table 2 summarizes the performance comparison between RRT, RRT*, Bi-RRT and the GBOPBi-RRT algorithm proposed in this paper in 3D space.
From Table 2, Figure 10 and Figure 11, it can be seen that in the spherical environment, GBOPBi-RRT significantly outperforms RRT, RRT*, and Bi-RRT in terms of path length, running time, number of generated nodes and number of iterations. Compared with RRT, the path length is reduced by 43.21%, the planning time by 60.71%, and the number of nodes and iterations by 95.91% and 98.35%, respectively; compared with RRT*, the path length and planning time are reduced by 27.47% and 39.69%, and the number of nodes and iterations are reduced by 94.15% and 98.05%, respectively; compared with Bi-RRT, the path length and planning time are reduced by 30.33% and 44.87%, and the number of nodes and iterations are reduced by 42.5% and 36.84%, respectively. Comprehensively, GBOPBi-RRT can search for feasible puncture paths more efficiently and stably, which fully verifies the effectiveness and rationality of the strategy in this paper.

5. Conclusions

In this paper, we study the flexible needle puncture path planning problem based on the single-wheeled vehicle model and the flexible needle reachable space, systematically analyze the geometry of the feasible trajectory of the flexible needle, and carry out a systematic experimental study, which lays a theoretical foundation for circular arc fitting. On this basis, the GBOPBi-RRT algorithm is proposed in the framework of Bi-RRT: it incorporates gravitational guidance, bi-directional adaptive expansion, optimal node selection based on A* and path optimization strategy, which significantly improves the search efficiency and path quality. The theoretical analysis verifies the completeness and asymptotic optimality of GBOPBi-RRT. Comparison with RRT, RRT* and Bi-RRT in various complex environments through MATLAB simulation shows that GBOPBi-RRT significantly outperforms the comparative algorithms in terms of path length, computation time and the number of nodes, and in particular, in the three-dimensional environment, the length of the planned paths of the improved GBOPBi-RRT algorithm is 43.21%, 27.47% and 30.33% less than that of RRT, RRT* and Bi-RRT, respectively. Additionally, if appropriate parameters are set, this algorithm can be applied to fields such as transportation problems, robot motion control, and other areas. This study has several limitations. First, the proposed method mainly addresses path planning in static environments. During actual puncture procedures, factors such as model parameter deviations, limited sensor accuracy, and variations in biological tissue properties may lead to discrepancies between the planned and actual paths. In complex anatomical environments, the proposed algorithm may still fall into local minima. In addition, this work does not incorporate real-time control for intraoperative path adjustment based on navigation feedback or information from the flexible needle tip, obstacles, and target positions within tissue. These factors further increase the difficulty of flexible needle path planning and control. Even so, the proposed algorithm establishes a solid basis for future studies on real-time intraoperative path optimization, which will be an important direction of subsequent research.

Author Contributions

Conceptualization, S.W. and Y.R.; methodology, S.W. and Y.R.; software, Y.R. and Z.C.; validation, S.W.;formal analysis, S.W. and Y.R.; investigation, S.W., Y.R. and Z.C.; data curation, Z.C.; writing—original draft preparation, Y.R.; writing—review and editing, Y.R. and S.W.; visualization, Z.C.; project administration, Z.C. All authors have read and agreed to the published version of the manuscript.

Funding

This research was supported by Guangxi Natural Science Foundation (Grant No. 2025GXNSFHA069207) and Innovation Project of Guangxi Graduate Education (Grant No. YCSW2025584).

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Data Availability Statement

The original contributions presented in this study are included in the article. Further inquiries can be directed to the corresponding author(s).

Conflicts of Interest

The authors declare no conflicts of interest.

References

  1. Zhang, Y.-D.; Zhao, Y.-J.; Tu, F.; Chen, H.; Zhang, Y.-H. A Review on Path Planning of Flexible Needle. J. Harbin Univ. Sci. Technol. 2011, 16, 7–11. [Google Scholar]
  2. Li, P.; Yang, Z.; Jiang, S. Needle-tissue interactive mechanism and steering control in image-guided robot-assisted minimally invasive surgery: A review. Med. Biol. Eng. Comput. 2018, 56, 931–949. [Google Scholar] [CrossRef]
  3. Duan, X.-G.; Wen, H.; He, R.; Li, X.; Qiu, J. Research progress and key technologies of thoraco-abdominal percutaneous puncture robots. Robot 2021, 43, 567–584. [Google Scholar]
  4. Zhang, H.; Zhao, Y.-J.; Jin, Y.-X.; Duan, H.-L. Path planning algorithm of steerable flexible needle: A review. Expert Syst. Appl. 2025, 287, 128270. [Google Scholar] [CrossRef]
  5. Alterovitz, R.; Lim, A.; Goldberg, K.; Chirikjian, G.S.; Okamura, A.M. Steering flexible needles under Markov motion uncertainty. In Proceedings of the 2005 IEEE/RSJ International Conference on Intelligent Robots and Systems, Edmonton, AB, Canada, 2–6 August 2005; pp. 1570–1575. [Google Scholar]
  6. Alterovitz, R.; Siméon, T.; Goldberg, K. The stochastic motion roadmap: A sampling framework for planning with Markov motion uncertainty. In Proceedings of the Robotics: Science and Systems, Atlanta, GA, USA, 27–30 June 2007; pp. 1–10. [Google Scholar]
  7. Akopov, A.S.; Beklaryan, L.A. Evolutionary Synthesis of High-Capacity Reconfigurable Multilayer Road Networks Using a Multiagent Hybrid Clustering-Assisted Genetic Algorithm. IEEE Access 2025, 13, 53448–53453. [Google Scholar] [CrossRef]
  8. Huang, C.; Zhao, Y.; Zhang, M.; Yang, H. APSO: An A*-PSO Hybrid Algorithm for Mobile Robot Path Planning. IEEE Access 2023, 11, 43238–43242. [Google Scholar] [CrossRef]
  9. Dijkstra, E.W. A note on two problems in connexion with graphs. Numer. Math. 1959, 1, 269–271. [Google Scholar] [CrossRef]
  10. Huang, Y.; Yu, L.; Zhang, F. A survey on puncture models and path planning algorithms of bevel-tipped flexible needles. Heliyon 2024, 10, e25002. [Google Scholar] [CrossRef] [PubMed]
  11. Wang, D.; Zheng, S.; Ren, Y.; Du, D. Path planning based on the improved RRT* algorithm for the mining truck. Comput. Mater. Contin. 2022, 70, 6075–6087. [Google Scholar] [CrossRef]
  12. Huang, B.; Liu, J.; Li, H.; Li, X.; He, R. Research on the path planning method for multi-axis sorting roboticarms under complex working conditions. Mach. Des. Manuf. 2025, 7, 24–33. [Google Scholar]
  13. Zhao, Y.J.; Zhang, Y.D.; Tu, F. Reverse Path Planning for Flexible Needle in 2D Soft Tissue with Obstacles. Appl. Mech. Mater. 2012, 121, 4132–4137. [Google Scholar] [CrossRef]
  14. Bobrenkov, O.A.; Lee, J.; Park, W. A new geometry-based plan for inserting flexible needles to reach multiple targets. Robotica 2014, 32, 985–1004. [Google Scholar] [CrossRef]
  15. Huo, B.; Zhao, X.; Han, J.; Xu, W. Path-tracking control of bevel-tip needles using Model Predictive Control. In Proceedings of the IEEE 14th International Workshop on Advanced Motion Control (AMC), Auckland, New Zealand, 22–24 April 2016; pp. 197–202. [Google Scholar] [CrossRef]
  16. Li, X.; Li, P.; Xiong, J. Path planning for flexible needle based on environment properties and random method. Comput. Eng. Appl. 2017, 53, 121–125. [Google Scholar] [CrossRef]
  17. Li, M.; Lei, Y.; Huang, C.; Hu, Y.D.; Du, S.; Guan, H.; Gao, D.D. Flexible Needle Path Planning Based on the Iterative Learning Algorithm. J. Mech. Eng. 2021, 57, 128–137. [Google Scholar] [CrossRef]
  18. Xiong, P.W.; Zhou, X.T.; Li, Q.; Song, A.G.; Liu, X.P. Path prediction of flexible needles based on Fokker-Planck equation and disjunctive Kriging model. J. Southeast Univ. (Engl. Ed.) 2022, 38, 118–125. (In English) [Google Scholar] [CrossRef]
  19. Ackerman, C. Robot steering with spectral image information. IEEE Trans. Robot. 2005, 21, 247–258. [Google Scholar] [CrossRef]
  20. Zhang, Y.; Qi, Z.; Zhang, H. An Improved RRT* Algorithm Combining Motion Constraint and Artificial Potential Field for Robot-Assisted Flexible Needle Insertion in 3D Environment. In Proceedings of the 2021 3rd International Conference on Industrial Artificial Intelligence (IAI), Shenyang, China, 8–11 November 2021; IEEE: Piscataway, NJ, USA, 2021; pp. 1–6. [Google Scholar]
  21. Zhao, B.-L.; Shao, S.-P.; Lei, L.; Wang, X.-W.; Yang, X.-J.; Wang, Q. Curve Fitting-Based Dynamic Path Planning and Tracking Control for Flexible Needle Insertion. IEEE Trans. Biomed. Eng. 2025, 72, 654–665. [Google Scholar] [CrossRef]
  22. Lei, Y.; Du, S.; Li, M.; Xu, T.; Hu, Y.; Wang, Z. Needle-tissue interaction model based needle path planning method. Comput. Methods Programs Biomed. 2024, 245, 108027. [Google Scholar] [CrossRef]
  23. Kuffner, J.J.; LaValle, S.M. RRT-connect: An efficient approach to single-query path planning. In Proceedings of the Millennium Conference IEEE International Conference on Robotics and Automation Symposia (ICRA), San Francisco, CA, USA, 24–28 April 2000; pp. 995–1001. [Google Scholar]
  24. Wang, X.; Wang, T.; Ding, W. Path Planning of Robot Manipulator Based on Improved Artificial Potential Field Method. Mach. Tool Manuf. Autom. 2022, 6, 24–27. [Google Scholar]
  25. Sun, L.; Zhao, Y.; Zhang, J. Research on path planning algorithm of unmanned ship. In Proceedings of the 4th 2024 International Conference on Autonomous Unmanned Systems (ICAUS 2024), Beijing, China, 18–20 October 2024; Springer: Berlin/Heidelberg, Germany, 2025; pp. 1–12. [Google Scholar]
  26. Huang, Z.; Jiang, C.; Shen, C.; Liu, B.; Huang, T.; Zhang, M. A hybrid dynamic path-planning method for obstacle avoidance in unmanned aerial vehicle-based power inspection. World Electr. Veh. J. 2025, 16, 123. [Google Scholar] [CrossRef]
  27. Sun, L.; Zhao, Y.; Zhang, J. Research on path planning algorithm of unmanned ship in narrow water area. J. Phys. Conf. Ser. 2021, 2029, 012122. [Google Scholar] [CrossRef]
  28. Jian, X.; Zou, T.; Vardy, A.; Bose, N. A hybrid path planning strategy of autonomous underwater vehicles. In Proceedings of the IEEE/OES Autonomous Underwater Vehicles Symposium (AUV), St. Johns, NL, Canada, 30 September–2 October 2020. [Google Scholar] [CrossRef]
  29. Webster, R.J., III; Kim, J.S.; Cowan, N.J.; Chirikjian, G.S.; Okamura, A.M. Nonholonomic modeling of needle steering. Int. J. Robot. Res. 2006, 25, 509–525. [Google Scholar] [CrossRef]
  30. Webster, R.J.; Memisevic, J.; Okamura, A.M. Design considerations for robotic needle steering. In Proceedings of the 2005 IEEE International Conference on Robotics and Automation, Barcelona, Spain, 18–22 April 2005; pp. 3588–3594. [Google Scholar]
  31. Hung, B.T.; Sekar, M.; Esi, A.; Kumar, R.S. Applications of Mathematics in Science and Technology—International Conference on Mathematical Applications in Science and Technology; CRC Press: Boca Raton, FL, USA, 2025. [Google Scholar]
  32. Zhao, Y.-J.; Liu, Z.-H.; Zhang, Y.-D.; Liu, Z.-Q. Kinematic model and its parameter identification for cannula flexible needle insertion into soft tissue. Adv. Mech. Eng. 2019, 11, 168781401985218. [Google Scholar] [CrossRef]
  33. Duindam, V.; Alterovitz, R.; Sastry, S.; Goldberg, K. Screw-based motion planning for bevel-tip flexible needles in 3D environments with obstacles. In Proceedings of the IEEE International Conference on Robotics and Automation, Pasadena, CA, USA, 19–23 May 2008; pp. 2483–2488. [Google Scholar]
  34. Minhas, D.S.; Engh, J.A.; Fenske, M.M.; Riviere, C.N. Modeling of needle steering via duty-cycled spinning. In Proceedings of the 29th Annual International Conference of the IEEE Engineering in Medicine and Biology Society, Lyon, France, 23–26 August 2007; pp. 2756–2759. [Google Scholar]
Figure 1. Overall system architecture diagram.
Figure 1. Overall system architecture diagram.
Algorithms 18 00702 g001
Figure 2. Schematic diagram of the extension of the traditional Bi-RRT algorithm.
Figure 2. Schematic diagram of the extension of the traditional Bi-RRT algorithm.
Algorithms 18 00702 g002
Figure 3. Schematic diagram of node expansion in a gravitational field.
Figure 3. Schematic diagram of node expansion in a gravitational field.
Algorithms 18 00702 g003
Figure 4. Path trimming schematic.
Figure 4. Path trimming schematic.
Algorithms 18 00702 g004
Figure 5. Unicycle kinematic model of the flexible needle. O 1 is the circular trajectory of the flexible needle at this moment with radius r 1 , and O 2 is the circular trajectory of the flexible needle at the next moment with radius r 2 .
Figure 5. Unicycle kinematic model of the flexible needle. O 1 is the circular trajectory of the flexible needle at this moment with radius r 1 , and O 2 is the circular trajectory of the flexible needle at the next moment with radius r 2 .
Algorithms 18 00702 g005
Figure 6. (a) is the flexible needle with two-dimensional reachable spatial extent. (b) is the flexible needle with three-dimensional reachable spatial extent.
Figure 6. (a) is the flexible needle with two-dimensional reachable spatial extent. (b) is the flexible needle with three-dimensional reachable spatial extent.
Algorithms 18 00702 g006
Figure 7. Schematic diagram of 2D path planning in the first type of simulation map environment. (a) is the RRT algorithm. (b) is the RRT* algorithm. (c) is the Bi-RRT algorithm. (d) is the GBOPBi-RRT algorithm. (e) is the fit path planned by GBOPBi-RRT.
Figure 7. Schematic diagram of 2D path planning in the first type of simulation map environment. (a) is the RRT algorithm. (b) is the RRT* algorithm. (c) is the Bi-RRT algorithm. (d) is the GBOPBi-RRT algorithm. (e) is the fit path planned by GBOPBi-RRT.
Algorithms 18 00702 g007
Figure 8. Schematic diagram of 2D path planning in the second type of simulation map environment. (a) is the RRT algorithm. (b) is the RRT* algorithm. (c) is the Bi-RRT algorithm. (d) is the GBOPBi-RRT algorithm. (e) is the fit path planned by GBOPBi-RRT.
Figure 8. Schematic diagram of 2D path planning in the second type of simulation map environment. (a) is the RRT algorithm. (b) is the RRT* algorithm. (c) is the Bi-RRT algorithm. (d) is the GBOPBi-RRT algorithm. (e) is the fit path planned by GBOPBi-RRT.
Algorithms 18 00702 g008
Figure 9. Comparative charts of various data. (a) is the path length comparison chart. (b) is the comparison chart of the time of the experiment. (c) is the graph comparing the number of nodes. (d) is the comparison chart of the number of iterations.
Figure 9. Comparative charts of various data. (a) is the path length comparison chart. (b) is the comparison chart of the time of the experiment. (c) is the graph comparing the number of nodes. (d) is the comparison chart of the number of iterations.
Algorithms 18 00702 g009
Figure 10. Schematic diagram of 3D path planning in the first type of simulation map environment. (a) is the RRT algorithm. (b) is the RRT* algorithm. (c) is the Bi-RRT algorithm. (d) is the GBOPBi-RRT algorithm. (e) is the fit path planned by GBOPBi-RRT.
Figure 10. Schematic diagram of 3D path planning in the first type of simulation map environment. (a) is the RRT algorithm. (b) is the RRT* algorithm. (c) is the Bi-RRT algorithm. (d) is the GBOPBi-RRT algorithm. (e) is the fit path planned by GBOPBi-RRT.
Algorithms 18 00702 g010
Figure 11. Schematic diagram of 3D path planning in the second type of simulation map environment. (a) is the RRT algorithm. (b) is the RRT* algorithm. (c) is the Bi-RRT algorithm. (d) is the GBOPBi-RRT algorithm. (e) is the fit path planned by GBOPBi-RRT.
Figure 11. Schematic diagram of 3D path planning in the second type of simulation map environment. (a) is the RRT algorithm. (b) is the RRT* algorithm. (c) is the Bi-RRT algorithm. (d) is the GBOPBi-RRT algorithm. (e) is the fit path planned by GBOPBi-RRT.
Algorithms 18 00702 g011
Figure 12. Comparative charts of various data. (a) is the path length comparison chart. (b) is the comparison chart of the time of the experiment. (c) is the graph comparing the number of nodes. (d) is the comparison chart of the number of iterations.
Figure 12. Comparative charts of various data. (a) is the path length comparison chart. (b) is the comparison chart of the time of the experiment. (c) is the graph comparing the number of nodes. (d) is the comparison chart of the number of iterations.
Algorithms 18 00702 g012
Table 1. Experimental data in two circular obstacle environment.
Table 1. Experimental data in two circular obstacle environment.
ArithmeticPath LengthExperimental Time (s)Number of NodesNumber of Iterations
RRT1264.5512.17400448
RRT*1109.824.56384421
Bi-RRT1234.672.388094
GBOPBi-RRT947.331.5048108
Table 2. Experimental data in two spherical obstacle environment.
Table 2. Experimental data in two spherical obstacle environment.
ArithmeticPath LengthExperimental Time (s)Number of NodesNumber of Iterations
RRT260.475.88562728
RRT*203.953.83393614
Bi-RRT212.314.194019
GBOPBi-RRT147.922.312312
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

Wang, S.; Ran, Y.; Chen, Z. An Improved Bi-RRT Algorithm for Optimal Puncture Path Planning. Algorithms 2025, 18, 702. https://doi.org/10.3390/a18110702

AMA Style

Wang S, Ran Y, Chen Z. An Improved Bi-RRT Algorithm for Optimal Puncture Path Planning. Algorithms. 2025; 18(11):702. https://doi.org/10.3390/a18110702

Chicago/Turabian Style

Wang, Shigang, Yunqi Ran, and Zhan Chen. 2025. "An Improved Bi-RRT Algorithm for Optimal Puncture Path Planning" Algorithms 18, no. 11: 702. https://doi.org/10.3390/a18110702

APA Style

Wang, S., Ran, Y., & Chen, Z. (2025). An Improved Bi-RRT Algorithm for Optimal Puncture Path Planning. Algorithms, 18(11), 702. https://doi.org/10.3390/a18110702

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