Next Article in Journal
Pressure Sensor System for Customized Scoliosis Braces
Next Article in Special Issue
Functional Self-Awareness and Metacontrol for Underwater Robot Autonomy
Previous Article in Journal
Optical Flow Estimation by Matching Time Surface with Event-Based Cameras
Previous Article in Special Issue
Antidisturbance Control for AUV Trajectory Tracking Based on Fuzzy Adaptive Extended State Observer
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Online 3-Dimensional Path Planning with Kinematic Constraints in Unknown Environments Using Hybrid A* with Tree Pruning

by
Jonatan Scharff Willners
1,*,
Daniel Gonzalez-Adell
1,
Juan David Hernández
2,
Èric Pairet
3 and
Yvan Petillot
1
1
Institute of Sensors, Signals and Systems, Heriot-Watt University, Edinburgh EH14 4AS, UK
2
Centre for Artificial Intelligence, Robotics and Human-Machine Systems (IROHMS), Cardiff University, Cardiff CF24 3AA, UK
3
Edinburgh Centre for Robotics, University of Edinburgh and Heriot-Watt University, Edinburgh EH14 4AS, UK
*
Author to whom correspondence should be addressed.
Sensors 2021, 21(4), 1152; https://doi.org/10.3390/s21041152
Submission received: 15 January 2021 / Revised: 2 February 2021 / Accepted: 4 February 2021 / Published: 6 February 2021
(This article belongs to the Special Issue Intelligence and Autonomy for Underwater Robotic Vehicles)

Abstract

:
In this paper we present an extension to the hybrid A* (HA*) path planner. This extension allows autonomous underwater vehicle (AUVs) to plan paths in 3-dimensional (3D) environments. The proposed approach enables the robot to operate in a safe manner by accounting for the vehicle’s motion constraints, thus avoiding collisions and ensuring that the calculated paths are feasible. Secondly, we propose an improvement for operations in unexplored or partially known environments by endowing the planner with a tree pruning procedure, which maintains a valid and feasible search-tree during operation. When the robot senses new obstacles in the environment that invalidate its current path, the planner prunes the tree of branches which collides with the environment. The path planning algorithm is then initialised with the pruned tree, enabling it to find a solution in a lower time than replanning from scratch. We present results obtained through simulation which show that HA* performs better in known underwater environments than compared algorithms in regards to planning time, path length and success rate. For unknown environments, we show that the tree pruning procedure reduces the total planning time needed in a variety of environments compared to running the full planning algorithm during replanning.

1. Introduction

Marine robots have revolutionised our understanding of the marine environment and our ability to access and exploit it as they can venture far beyond where humans can in this extreme environment. As of today, remotely operated vehicle (ROVs) are still the norm in many underwater applications but they are limited as they require a support ship, an operator and a tether to provide power and control to the system. Autonomous marine robots are now a mature technology for survey and their autonomy (and capabilities) are rapidly increasing, enabling them to operate for longer periods, with both less and more efficient human supervision [1], and even the possibility to be permanently deployed using underwater docking and charging stations [2].
The ability to guarantee precise and robust trajectories is a critical capability for most robots, however, this is particularly challenging for underwater vehicles because, in general, they are non-holonomic and subject to unpredictable external forces such as currents and waves. Moreover, underwater robots often operate in unknown environments and they have to adapt their path to the terrain (including obstacles) online. Collisions in the maritime domain can have serious consequences as damage to the vehicle might lead to leakage, internal damage of the hardware and, in the worst-case scenario, loss of the asset.

1.1. Related Work

Motion planning of traditional robots is a widely researched area [3]. In the maritime domain, the motion planning problem is less extensively researched and most planners consider only geometric constraints. For a mobile robot to operate autonomously it needs to be able to find a solution to a start-to-goal query. This solution helps the robot to navigate from a start configuration to a goal configuration or region. A valid solution needs to be collision-free in the configuration space (C-Space) (a space that contains all possible configuration of the robot) [4]. The C-Space includes position in n dimensions, noted as R n . The orientation of a C-Space is noted as S O ( n ) . For both position and orientation this is noted as S E ( n ) = R n × S O ( n ) . For an underwater robot moving in three dimensions, the C-Space would have 6 dimensions— S E ( 3 ) = [x, y, z, roll ( φ ), pitch ( θ ), yaw ( ψ )]. Table 1 presents an overview of some of the previous work with emphasis on the capabilities relating to C-Space, kinematic constraints, online planning and if the approach was used with autonomous underwater vehicles (AUVs).
Widely used approaches for path planning are search-based or grid-based methods such as Dijkstra’s Algorithm [5] and A* [6]. Grid-based methods create a discrete grid of the C-Space and apply graph search strategies to find a path that leads to a given goal configuration. The grid-based methods are fast and often find the optimal path based on the resolution of the grid. However, they do not necessarily scale well with the size and dimension of the C-Space. These methods are resolution-complete—if a solution exists in the discrete representation of the C-Space, the algorithm will find it. However, the discretisation balances computing requirements with accuracy and can lead to non-optimal solutions or failures if the grid is too coarse (e.g., for dealing with narrow passages). A grid-based approach presented by Tanakitkorn et al. [7] use a genetic algorithm (GA) that finds shorter paths than A* but with a much longer planning time.
A family of algorithms which does not rely on discretising the C-Space are sampling-based methods, or stochastic methods, such as probabilistic roadmap (PRM) [8] and rapidly-exploring random tree (RRT) [9]. These methods rely on randomly sampling configurations from the C-Space and connecting them to each other. By not relying on a discrete grid to perform the search, sampling-based approaches are not limited by the resolution of a grid in the same way as search-based methods are. This, however, comes with the drawback of optimality and completeness. Sampling-based methods are probabilistic complete meaning that, if a solution exists, the probability of finding it rises with search time with a limit of 1. However, they cannot guarantee that they will find a solution over a limited number of iterations. Later, extensions such as the asymptotically optimal RRT (RRT*) [10] were developed to overcome the optimality issues by introducing a re-wiring step to improve the path. The solution of this method will converge towards the optimal as the number of iterations goes towards infinity. A drawback of sampling-based algorithms is the lack of guarantees to find a solution and optimality.
For non-holonomic robots, finding a collision-free path is not sufficient. The path also needs to take the motion constraints of the vehicle into consideration. The original form of grid-based methods such as Dijkstra’s and A* do not take this into account. An approach by Yan et al. [11] uses A* with a circular search to ensure that the path is feasible for an AUV. Pivtoraiko et al. [12] extended A* to connect states based on Reeds–Shepp curves with the condition that the configurations are in the centre of the cells and that their orientations are contained in a discrete set, see Figure 1b. Another approach to solving the path planning problem under motion constraints with a search-based method is the hybrid A* (HA*) [13]. HA* allows states to have continuous values within the cells as can be seen in Figure 1c. It has mainly been used for terrestrial vehicles operating in S E ( 2 ) .
There are multiple sampling-based algorithms which consider the motion constraints of the robot while planning a path. RRT was initially developed for kinematic planning [9]. expansive space trees (EST) [14] perform random sampling from a random state to explore the search space with kinematic constraints. EST was later extended to use a guided method to select what state to expand, to solve the query in fewer iterations [15]. Hernández et al. added Dubins curves [16] to enable RRT* to be used with kinematic constraints [17]. However, a major drawback of Dubins curves is that it only considers one radius for the curvature of the trajectory. stable sparse-RRT (SST) has been used for an AUV operating in S E ( 2 ) by Pairet et al. [18]. SST has also been used to bias the sampling to follow a lead calculated by RRT* [19,20]. Jian et al. use RRT* to find a global path in 2D which is then followed by dynamic window approach (DWA) while including the motion constraints of the AUV in  S E ( 2 ) [21].
The majority of the underwater domain remain unmapped, hence robots need to be capable of responding to new information about the environment. As such, if the environment contains structures or natural obstacles, the robot should preferably be able to both sense them and adjust the plan to avoid collisions. For terrestrial robots, dynamic A* (D*) [30], Field-D* [22] and anytime dynamic A* (ADA*) [24] have been proposed and successfully used thanks to their ability to handle changes in the environment without re-calculating a new solution from an empty search tree. However, these approaches are not suitable for non-holonomic vehicles as they do not take kinematic constraints into account. Instead, the majority of the path planning approaches that consider the kinematics of the vehicle discards the tree to replan a new path when the current path is no longer valid. As an alternative approach to discarding the tree, Bekris and Kavraki [31] proposed to keep the paths that lead to the goal. This was used with a sampling-based planner guided by a heuristic which incorporates the kinematics of the robot and hence can incrementally improve the solution and potentially use other solutions in replanning. Another approach to improve replanning time is through pruning the tree of infeasible paths when new obstacles are sensed which have been used with Dynamic-RRT by Ferguson et al. [32]. Tree pruning was also used with kinematic based paths with RRT* to reuse the last best known solution for an AUV [17,33].
In this paper, we present an extension to HA* to plan feasible and collision-free paths for underwater robots operating in S E ( 3 ) . Insight in the proposed extension is given in Section 2. Furthermore, in Section 3, we endow the planner with a tree pruning procedure which updates and maintains a valid search tree during operation in unexplored environments. The tree pruning step enables the reuse of previously explored paths, leading to improved on-board online replanning capabilities. HA* is resolution complete, just as A* and state-lattice A*, but HA* is able to utilise more of the discrete space due to using continuous values. HA* has an advantage over probabilistic complete approaches, as HA* is able to report if no solution exists. If the query cannot be solved, this can be reported and handled at a higher level in the autonomy. Our approach is motivated by the fact that many AUVs have non-holonomic motion constraints. Work such as RRT* with Dubins in S E ( 3 ) , which includes replanning capabilities [17], is limited by constant turning radius based on the surge speed of the robot and is limited to AUVs with hovering capabilities to operate in 3D. However, many types of AUVs are required to adjust their pitch angle to change depth, for these vehicles this dimension should be included during planning. We show the efficiency of the algorithm in both known and unexplored environments in Section 4. Finally, we conclude the paper in Section 5.

1.2. Statement of Contributions

The main contributions of this manuscript can be summarised as follows:
  • Extending HA* for robots operating in S E ( 3 ) . The approach is focused on AUVs and includes domain-related constraints.
  • Improved HA* operation in unexplored environments by applying a tree pruning procedure which maintains a valid search tree that can be reused when replanning is needed.
  • Our proposed approach shows improved results in known environments regarding planning time, success rate and path length (quality of solution) compared to state-lattice A*, RRT and RRT* with Dubins curves.
  • For unexplored environments, we show a consistent reduction in planning time by using the tree pruning procedure compared to discarding the tree and planning from scratch.

2. Hybrid-A* for the Underwater Domain

HA* was initially used for autonomous cars by Dolgov et al. [13,26], who experimentally showed that HA* is capable of planning in low enough time for online operation in S E ( 2 ) . In this section, we will describe our adaptation of the algorithm to enable operation in S E ( 3 ) and the underwater domain. However, underwater robots, compared to terrestrial, are often equipped with less computational power as the physical space for computers and payloads is severely limited. This often means that a single, or in some cases a couple of computers, need to handle all computations from low-level control to mapping, planning and data acquisition (e.g., SPARUS II [34,35], Girona500 [36] and Iver3 (https://auvac.org/files/uploads/platform_pdf/iver3_auv_brochure.pdf (accessed on 6 February 2021)) are equipped with one computer in the basic form while ASTERx, which is a larger AUV, is endowed with two computers (https://www.eurofleets.eu/vessel/auv-asterx-or-idefx/ (accessed on 6 February 2021)). Hence, relieving the computer of additional computational expense during planning is desirable. To improve the usage of HA*, in Section 3 we present our proposed extension to reduce planning time in unexplored environments by using tree pruning to maintain a feasible and collision-free search-tree that can be used for replanning.

2.1. Hybrid-A*

HA* [13] is an extension to A* [6] which, instead of discrete values, uses continuous values to represent the configuration of the robot. Both algorithms are part of grid-based search methods, which discretise the search space into a grid. The grid is constructed of cells. A* store states in the centre of the cells of the grid. In HA*, states are instead stored as continuous values within the cell [13]. This representation allows for continuous movement based on the kinematic of the vehicle within the search space, enabling HA* to find paths that are feasible (doable) for non-holonomic vehicles.
The HA* algorithm (see Algorithm 1) is based around using a priority queue, which is commonly referred to as the open list. The open list contains the states which have not yet been expanded and can lead to a possible solution. In each iteration, the algorithm removes the state ( q e x p ) from the open list with the highest priority (lowest cost) and, unless it fulfils the termination criteria, expands it. The cost, f ( q ) is the sum of the path cost g ( q ) and the heuristic cost h ( q ) as seen in (1).
f ( q ) = g ( q ) + h ( q )
The goal of the algorithm is to find a path which solves the query in the lowest possible cost (e.g., shortest path), therefore a state with a low cost is assigned high priority. The state that is selected for expansion is then expanded to explore the search space. The expansion to create new offsprings is based on the kinematic constraints of the robot. Each generated offspring needs to pass a validity check to be considered as a feasible candidate. If the new offspring does not pass this check it is discarded as it is either not feasible or it is not able to contribute in the search for the shortest path. If the cell which the state ends up in is free or the cell has a higher cost and the trajectory is collision-free, the new state is added to the open list and the cell is updated (this is further described in Section 2.2.4). When all offsprings have been processed the algorithm continues on its next iteration and selects the next state for expansion. This process is repeated iteratively until the goal has been reached or until the open list is empty when the algorithm selects a new state for expansion. The termination condition is usually to reach a certain configuration or to be within a region. If the open list is empty when the next state is selected for expansion, it means that all of the reachable configurations under the specified resolution have been searched without finding a solution, and therefore no solution exists for the given conditions.
Algorithm 1 Hybrid A*
Input:
X s t a r t , X g o a l : Start and goal configuration
grid : Grid
O : Obstacles
    1:
procedure HA*
    2:
     q s t a r t = X s t a r t
    3:
     g r i d ( q s t a r t ) . l i s t . i n s e r t ( q s t a r t )        ▹ add state to the cell’s list
    4:
     O p e n L i s t = P r i o r i t y Q u e u e ( )
    5:
     O p e n L i s t . i n s e r t ( q s t a r t )
    6:
    while O p e n L i s t ! = do
    7:
         q e x p = O p e n L i s t . p o p ( )
    8:
        if q e x p X g o a l r e g i o n then
    9:
           return q e x p                       ▹ Solution found
    10:
        end if
    11:
         q n e w = E x p a n d ( q e x p , O )
    12:
        for each q ^ n e w q n e w do
    13:
           if V a l i d ( q ^ n e w , g r i d ) then
    14:
                g r i d ( q ^ n e w ) . l i s t . i n s e r t ( q ^ n e w )
    15:
                O p e n L i s t . i n s e r t ( q ^ n e w )
    16:
           end if
    17:
        end for
    18:
    end while
    19:
    return
    20:
end procedure

2.2. Hybrid-A* in the Underwater Domain

The original HA* algorithm was mainly limited to autonomous cars in S E ( 2 ) . We extend the algorithm to cope with 3D workspaces and therefore planning in S E ( 3 ) C-Space. Hence, the algorithm needs to be able to handle the new degrees of freedom: depth (z), roll ( φ ) and pitch ( θ ). Due to the nature of sensors used for data gathering and navigational purposes, roll and pitch are treated differently. While submerged, the robot has generally no access to absolute positioning. Instead, the robot often relies on internal sensors to estimate its position. A common approach to estimate the robot’s position is through a doppler velocity log (DVL). A DVL transmits acoustic signals and measures the Doppler shift in the returning signal which can be translated into relative velocity towards the surface the signal was reflected off. However, if the angle of the signal compared to the surface of the medium it reflects off is too high, the signal might be lost as the returning angle of the acoustic signal is not towards the sensor. This causes the sensor to lose bottom-lock and not be able to estimate its velocity and hence not position. Therefore, if the angle of pitch is too far from the horizontal plane the position estimation might not work as well as required to follow a planned trajectory. Hence, if a state has a pitch angle larger than the accepted range, the state will be seen as non-valid. While pitching might reduce the quality of such sensors, it is for some vehicles necessary to change depth. Roll, however, is in most cases not desirable and therefore planning in such dimension is not considered.

2.2.1. Expansion of a State Using Motion Primitives

When a state is expanding (line 11 in Algorithm 1), we propose to use a set of motion primitives that defines a discrete set of motions which are feasible for the vehicle. Discretising the robot’s kinematic range into a set of feasible motions reduces the search space and, therefore, lowers the computational time required to solve a query. The set of motion primitives, noted as Φ , consists of n different branches (noted ϕ ). Each branch represents a continuous motion and consists of k intermediate configurations used to check for collision with the known environment. This pre-calculated set of motions only needs to be defined once. All the branches in the set of motion primitives originates from q 0 = [ 0 , 0 , 0 , 0 , 0 , 0 ] . Every intermediate configuration ( [ ϕ 1 , . . , ϕ k ] ) of a branch can then be transformed to the expanding state ( q e x p ) to get its state in the planning frame.
For this paper, we define the motion primitives such that they can be followed by non-holonomic robots, without hovering capabilities. The motion primitives of the robots are represented using the kinematic model of a bicycle, both for the movement in the horizontal and vertical plane. By using this kinematic model, a set of motion primitives such the one shown in Figure 2 can be created.

2.2.2. Binary Search for a Lower Cost Motion Primitive

When a state q e x p has been expanded to produce new offsprings, we apply a binary search over the branches leading up to the offsprings. This search is used to find a new state, which is the closest (based on the resolution of the search) reachable configuration from q e x p to X g o a l within the motion constraints of the motion primitives. The binary search is recursively applied for m iterations and can be seen in Algorithm 2. After m iterations, the recursive function returns the branch which results in the state closest to X g o a l . An example of how one iteration of this generates a new branch ( Ψ ^ ) can be seen in Figure 3. After the m iterations, the search-tree is expanded with the branch found as the most favourable by the binary search. If the motion primitives such as the one pictured in Figure 2 are used, the new branch will reach, if within the outer limits, a heading which is closer towards the goal than the branches in the set of motion primitives. Using the binary search to generate a state closer to the goal will enable the planner to find a path which is reaching the goal region faster as can be seen in Figure 3b,c due to being able to extend a straight path towards the goal.
Algorithm 2 BinarySearch
Input:
Ψ : Set of branches
m : iterations
    1:
procedure BinarySearch
    2:
     Ψ i = m i n _ h _ c o s t ( Ψ )      ▹ End state of the branch with the lowest heuristic cost
    3:
     Ψ ^ 1 = Ψ i
    4:
     Ψ ^ 2 = m i n _ h _ c o s t ( Ψ i 1 , Ψ i + 1 )
    5:
     Ψ ^ a v g = a v e r a g e ( Ψ ^ 1 , Ψ ^ 2 )                              ▹ Branch in-between Ψ ^ 1 and Ψ ^ 2
    6:
     Ψ = { Ψ ^ 1 , Ψ ^ a v g , Ψ ^ 2 }
    7:
    if m = = 0 then
    8:
        return m i n _ h _ c o s t ( Ψ )
    9:
    else
    10:
         B i n a r y S e a r c h ( Ψ , m 1 )
    11:
    end if
    12:
end procedure

2.2.3. Priority of Expansion

When a new state is created, it is assigned a cost based on the cost to reach the state from the root of the tree and the heuristic cost to reach the goal. If the heuristic is equal or lower than the actual cost of moving from a state to the goal, the path found will be the optimal path [37]. If the heuristic is higher than the cost to reach the goal, the algorithm becomes greedy, giving a larger bias to expand states closer to the goal. Using a weighted heuristic, multiplying h ( q ) with a weight ( ϵ ) in (1), can therefore speed up the algorithm but does not guarantee finding the optimal path. Instead, the algorithm can find a solution which is at worst ϵ times longer than the optimal [38]. The higher the weight ϵ , the greedier the search becomes and the less it is focused on exploring the search-space. When ϵ = 1 , the algorithm becomes a breadth-first search as Dijkstra’s algorithm. The heuristic is calculated using Dubins curves [16]. Dubins curves are used to connect two configurations with the shortest path using a combination of the three segments consisting of constant curvatures Left and/or Right) and/or Straight segments. Dubins curves are originally implemented for 2D. To compensate for the vertical component of the two 3D configurations, we project them into a 2D space. The configurations are separated by the Euclidean distance to incorporate the vertical (z) component before finding the Dubins curves which connects them. Dubins curves as a heuristic are calculated using Open Motion Planning Library (OMPL) [39].

2.2.4. Expanding the Tree with a State

An expanding state will create new offsprings to be potential candidates which can be added to the search tree. The offspring needs to pass a validity check before being added to the tree. During the expansion of a state, each branch that is being expanded must be checked for validity, which includes the state being collision-free and passing the domain-related constraints.
For the previously used application of HA*, the planning has been in a plane and a discrete grid of 3 dimensions (x, y and θ ) has been used. As underwater robots operate in a 3D space, the discrete grid needs to include the additional dimensions. However, as previously stated, changing the roll is undesirable for many underwater vehicles and therefore we get a 5D grid consisting of: x, y, z, φ (pitch) and θ (yaw). The grid is a 3D volume consisting of voxels. Each voxel has been divided into two additional dimensions (for pitch and yaw). For consistency throughout the paper, we will refer to volume as grid and voxel as cell.
When a new state q e x p is created and it passes as being both collision-free and satisfying the domain-related constraints, the algorithm checks if the cell ( q c e l l ) which q e x p has its configuration in is free. If q c e l l is occupied, an evaluation of the new state is performed to check if it can provide a better solution than the state with the lowest path cost currently occupying the cell. When a state is expanded to the occupied cell, the following three scenarios exist and are handled as the following:
  • q e x p g _ c o s t = q c e l l g _ c o s t : As q e x p could have a slight difference from the ones already occupying the cell which might lead to a better solution the algorithm will allow q e x p to be added to the search tree.
  • q e x p g _ c o s t > q c e l l g _ c o s t : q e x p : The state is discarded as it is likely to lead to a worse solution.
  • q e x p g _ c o s t < q c e l l g _ c o s t : The new state finds a shorter path to q c e l l . We can however not change the parent as in A* or Dijkstra’s as this might not comply with the motion constraints of the robot and instead q e x p is added to the tree, and the new cost of the cell will now be q e x p g _ c o s t as this is the lowest cost of a state in the cell’s list.

3. Improved Replanning by Tree Pruning

When a vehicle is operating autonomously, it does not necessarily have all the information about its surroundings. It is therefore important to be able to map and react to new information about the environment in case such new information requires the vehicle to react in order to, for instance, avoid a collision.
Even if the robot is fully aware of its surroundings before initiating the mission, so that a collision-free and feasible path can be pre-calculated, the robot still needs to verify the validity of such a path during the mission’s execution. Continuous validation of the path helps the vehicle overcome some navigation cumulative errors or even changes in the environment. Hence, no matter the level of knowledge about the environment, it is beneficial for the robot to be able to react to its surroundings. If the robot is following its current calculated path towards the goal, and it is continuously mapping its surroundings using e.g., simultaneous localisation and mapping (SLAM) [40], it might sense an obstacle which invalidates the current path. To avoid collision, the robot needs to react to such an event. When such an event occurs, the robot can handle the situation in two different ways—either the current plan can be discarded and the path planning algorithm can solve the problem from scratch or the current plan can be repaired. The former being the simpler approach, as the planning algorithm can be run as a new instance and solve the start-to-goal query from the current configuration of the robot. The latter, however, can reduce the time or iterations to find a new valid solution. The primary problem when repairing a path which is based on the kinematics of the robot is that connecting two states might not be feasible without complicated manoeuvres. Instead, when planning under kinematic constraints, we apply a branch pruning procedure to enable the re-use of the previously explored paths. Our extension adds a pruning step to HA*. This step prunes the current explored search tree of branches which have been deemed infeasible due to collision with newly discovered obstacles.

3.1. Online Mapping and Collision Detection

Obstacles in the environment are uniquely perceivable by the robot when they lie in the detection range of the robot’s sensors. Therefore, as a robot moves through an environment, it incrementally discovers points on the boundary of nearby obstacles. To generate a representation of the surrounding environment online, we adopt a mapping strategy that fuses the robot’s observations into a probabilistic voxel representation. Specifically, we employ the facilities provided by OctoMap [41] to fuse the robot’s range-based data into a 3D occupancy grid map at variable resolution. Voxels in the grid map are initially categorised as unknown, and updated to occupied or free when multiple observations support such hypotheses. OctoMaps efficiently encode the observed environment as an octree data structure, thus optimising memory usage while, at the same time, providing fast access.
The OctoMap representing the sensed environment is periodically updated in the planner. In the map, a bounding box of the robot is used to check for collisions with Flexible Collision Library (FCL) [42]. When a state q e x p is expanded, the intermediate state of the branches in the set of motion primitives are incrementally transformed to the frame of q e x p . If the last intermediate state of a branch is collision-free and fulfils the validity check, the branch is valid and can be added to the tree. In Figure 4, the incremental collision check can be seen. To compensate for errors in vehicle control and noise in the sensing of the map, the environment and/or the bounding box for the robot can be inflated, see Figure 5. Each time the planner’s map is updated, the validity of the current solution is checked; if no longer valid, the planner prunes the tree before solving the query to find a new solution.

3.2. Tree Pruning

When operating in unknown environments, with the ability to perform online mapping, the robot can change its path during execution if needed to avoid collision with newly sensed obstacles in the environment. One approach to handle scenarios where the current path is deemed as no longer valid due to collision is to discard the solution and initiate a new planning problem from the current configuration. For geometric planners, approaches on how to repair the path have been proposed, such as ADA* [24] and Field-D* [22], to connect trees which remain valid after removing the states which are in intersection with the environment. However, for planners incorporating the kinematic constraints of the vehicle, connecting a state to another, the right set of controls need to be found, hence making it a more difficult problem to solve. In this paper, we instead apply a tree pruning procedure, which maintains a valid search tree during operation. When the environment is updated, the tree is pruned of the branches the environment intersects with. By keeping a valid search-tree we can reuse previously explored paths and we can solve the query by initiating the HA* with a tree instead of a single root state. This can save time as the algorithm does not have to explore the paths which have already been explored in previous searches. When the currently known map is updated, the solution is checked if it is collision-free. If the path is still valid, the vehicle keeps moving towards the next waypoint. Whenever the robot reaches a waypoint, the state in the tree representing this waypoint is pruned and set as the new root, similar to what Hernández et al. proposed with an RRT* [28] for an AUV operating in S E ( 2 ) . The prior states are not kept as the tree is based on directed connections between states. A directed connection between states means that if a vehicle can move from q a to q b using a branch from the set of motion primitives, it does not mean that the robot can move from q b to q a using the same connection. If the updated map, however, leads to the solution colliding with the newly sensed obstacles, the algorithm enters the tree pruning step. The algorithm for pruning can be seen in Algorithm 3. The pruning step recursively traverses the tree and discards invalid states. When a connection between a state and its parent state is no longer valid, the corresponding branch will be pruned and as such all states that are dependent on the pruned state are also discarded. When the tree has been pruned, all of the remaining states are valid and the remaining tree is used in the HA* algorithm as an initial search tree. This approach for tree pruning based on new information about the environment has previously been used by Ferguson et al. [32] with Dynamic-RRT. If replanning from scratch (discarding the tree and planning from current configuration) using a deterministic approach, the algorithm will regrow a large portion of the tree which was discarded. Hence, using the pruned tree can remove the need to regrow a largely identical tree, therefore reducing the replanning time. An example of this can be seen in Figure 6 where the path in Figure 6a is no longer collision-free due to new observations of the environment. The tree is then pruned and used to find a new valid solution to the query.
Algorithm 3 PruneTree
Input:
q : State
O : Obstacles
    1:
procedure PruneTree
    2:
    if V a l i d ( q , O ) then
    3:
        for each q ^ q o f f s p r i n g s do
    4:
            P r u n e T r e e ( q ^ , O )
    5:
        end for
    6:
    else
    7:
         D e l e t e S t a t e ( q )             ▹ Delete state q (and all offsprings recursively) from tree
    8:
    end if
    9:
end procedure

4. Tests and Evaluation

In this section, we present comparative results for HA* in both known and unknown environments. All the results were performed in simulations on an i7-7700 CPU @ 2.80 GHz. The approach was implemented using C++ with Robot Operating System (ROS) [43].

4.1. Comparison in Known Environments

In this section, we present an evaluation of our HA* algorithm compared to state-lattice A* [12], the RRT [9] and an RRT* that uses Dubins curves [17]. We perform the comparison in the three different environments represented as OcotMaps shown in Figure 7.
The evaluation is performed by running our proposed HA* and state-lattice A* in each test scenario until they find a solution; as both planners are deterministic, they only need to be run once (A deterministic path planning approach will find the same path in the same time when the scenario and parameters are the same). RRT and RRT* are both sampling-based approaches with a stochastic behaviour, thus we run each of them 1000 times and present the mean, median, the minimum and maximum path length of the found solutions. The sampling-based approaches are evaluated with different planning times. They are initially given the same time required by HA* to find a solution, such that we can compare fairly the quality of their solutions (path length) and their success rates. Then, we increase their allowed planning time until they reach a success rate close to 1.0. As the methods are slightly different when operating in 3D, RRT* with Dubins curves is assuming hovering capabilities and diving without change in pitch and state-lattice A* does not scale well into 3D—therefore, this comparison is performed in S E ( 2 ) . The results of the comparison can be seen in Table 2. The set of motion primitives for HA* consists of 7 uniformly spread branches and the binary search is applied for 3 iterations.

4.1.1. Scenario 1: Gap

The first scenario (see Figure 7a) for the comparison in a known environment is an artificial structure containing two gaps, a smaller and a larger which the robot can go through or it can take the longer path around the structure, the query is ( [ 30 , 0 , 0 ] [ 30 , 0 , 0 ] ) . State-lattice A* requires longer time and finds a longer solution. Given the same planning time as HA*, neither of the sampling-based approaches manages to find a path which passes through the two gaps but instead circum-navigates the whole obstacle. In #1.6–1.10, the sampling-region for RRT and RRT* is set to a smaller region, forcing the path to go through the two gaps and as seen the success rate severely drops.

4.1.2. Scenario 2: Canyon

In the second test scenario (see Figure 7b), the robot moves through a natural-like terrain, consisting of a canyon and a rock. The query ( [ 25 , 10 , 0 ] [ 25 , 25 , 0 ] ) is solved faster by HA* than state-lattice A* and with a lower path length. The sampling-based approaches’ success rate is low given the same time as HA* needs to solve to query. When RRT* with Dubins curves is given roughly 20 times longer planning time than HA*, its success rate gets close to 1.0 but the average length of the solution is roughly 20% longer.

4.1.3. Scenario 3: Cave, Dead-End

The last scenario (see Figure 7c) represents the case where the robot is moving towards a dead-end, thus requiring it to turn back to avoid getting trapped in the cave due to its motion constraints. HA* is able to solve the query 0 , 2 , π 2 0 , 7 , π 2 while state-lattice A* cannot solve it due to its resolution. When the same planning time is given to sampling-based approaches as the time it takes for HA* to solve it, the success rate is low. A drawback in using RRT* with Dubins curves is that the turning radius of the robot is determined by a constant surge speed. This limits the dynamic behaviour of the robot compared to our presented HA* where the set of motion primitives considers a larger range of behaviours. Using a larger set of motions enables HA* to solve queries where a more precise combination of motions are needed to solve the query.

4.1.4. Known Environment—Results

The results from the experimental evaluation in a known environment can be seen in Table 2. Overall, HA* finds shorter paths (higher quality) in less time and with higher success rate than compared approaches. The planning time to solve the queries with a success rate of 1.0 is lower than compared approaches in all cases except for RRT in the gap scenario (see #1.4 in Table 2). However, in #1.4 the quality of the solution, the mean path length, is over twice the length as the path found by HA*. In the scenarios where other approaches manage to find a path length which is shorter than HA* (#2.3, #3.5, #3.6, #3.8 and #3.9) the planning time is higher and the success rate is lower (except in #3.9 where the success rate is also 1.0).

4.2. Comparison in Unknown Environments Using Tree Pruning

For the operation in unknown and unexplored environments, we integrate the described methods for mapping, motion planning and tree pruning capabilities with a robot in a UUV Simulator [44]. The simulated robot is equipped with a forward-looking sonar [45] to perceive the environment. We limit the range of the forward-looking sonar to 10 m. The sensor’s observations are fused into a probabilistic map online at 0.5 m resolution. For the simulated scenarios, we apply a weighted heuristic where ϵ = 1.5 and use a bounding box for the robot of 2 × 2 × 2 metres for collision checking. The set of motion primitives applied is as described in Figure 2, where each branch is 3 m long and has an intermediate state at every 0.25 m. The goal region is a sphere with a radius of 3 m. In this section, we compare our presented approach for replanning using HA* with tree pruning to planning from scratch. When replanning is required, a second instance of HA* is started to solve the problem from the current configuration using the sensed map but not the pruned tree.
The comparison is performed in the following 4 environments (which can be seen in Figure 8):
  • Scenario 1: Offshore structures
    The first scenario (see Figure 8a) that is considered consists of two common offshore structures: a blowout preventer (the model for this structure can be seen in Figure 8d) next to the foundation of a wind turbine.
  • Scenario 2: Circle/Narrow Exit
    The second scenario (see Figure 8b) is a circular structure with an exit. The robot starts from the inside of the structure and the goal region is on the outside. As such, it will first move straight towards the goal until it finds out that the path is blocked. The set of motion primitives is used without vertical movement in this scenario.
  • Scenario 3: Corridor
    The third scenario (see Figure 8c) is navigating through a corridor, where walls partially blocking the inner passage need to be circumnavigated. The set of motion primitives is used without vertical movement in this scenario.
  • Scenario 4: Offshore Incident/Cluttered
    The last scenario (see Figure 8d) is a cluttered environment, modelled as an offshore incident with wind turbines which have fallen over next to other offshore structures.
In all scenarios, the robot has no initial knowledge about the environment and the two compared approaches use the same parameters and set of motion primitives. The path planner generates the path which the robot follows until the vehicle either reaches the goal or senses an obstacle which intersects with the current plan. If the current plan gets invalidated, the planner prunes the current tree and uses this to plan a new path using our approach. The comparison between planning using the pruned tree and planning from scratch can be seen in Figure 9. The comparison includes the computational time (time for pruning and planning) to solve the query at each occasion replanning is required. In addition, we present the size of the final trees (and the size of the pruned tree) and the number of iterations needed to find a solution. The comparison results in Figure 9 show a significant reduction in computational time by using our proposed approach. In scenario 2 (Figure 9b), it can be seen at the sixth time of replanning that the new path is found after very few iterations using our approach. The pruned tree in such a case contains states which are close to solving the query. Therefore only a few iterations are needed to find a new solution. A similar situation can be seen in Figure 6. These results demonstrate that using a pruned tree instead of replanning from scratch can greatly reduce the computational time spent on planning.

5. Conclusions and Future Work

In this paper, we have presented two extensions to hybrid A* for online path planning in 3-dimensional unexplored environments. The first extends HA* to operate in S E ( 3 ) with a focus on usage for non-holonomic autonomous underwater vehicles. The second is endowing the planner with tree pruning capabilities to improve operations in unexplored environments. The tree pruning procedure maintains a valid search tree which can be used as an initial search condition when replanning is required. We show that our variant of the HA* planner can find shorter paths, with a higher success rate than RRT, RRT* with Dubins curves and state-lattice A* in known environments. For unexplored environments, we show a consistent reduction in total planning time required to solve a query when using tree pruning compared to replanning from scratch.
As any other search-based planners, the presented variant of the HA* planner is driven by heuristics that indicate the state with the highest priority from where to expand the tree. Such heuristic is counterproductive in environments where local minima exist, i.e., states that rank highly to the heuristic but do not lead to a solution, as it forces search-based planners to explore all local minima states before the planner can find a path around them. One example of such a scenario could be in scenario 1 for known environments, gap (see Figure 7a). If the second gap had been closed, HA* would still have explored the whole space within the structure. Sampling-based approaches would, instead, find a path around it as seen in the results section for such scenario. Improving the algorithm behaviour in such scenarios would greatly benefit the overall applicability of HA*.
For the future, we are planning to integrate the approach with an AUV for real-world tests. The tree pruning procedure in this paper assumes a directed connection between nodes. Extending the tree pruning to include indirect connections could improve the usage for vehicles able to reverse, as it would enable revisiting a previous state. As online planning is critical for autonomous operation for AUVs, we are looking at reducing the total planning time further and alternative approaches to pruning the tree more efficiently.

Author Contributions

The extension of hybrid A* for SE(3) was developed by J.S.W. and D.G.-A.; the tree pruning was developed by J.S.W.; the mapping method was implemented by È.P.; the sampling-based approaches used for the comparison was developed by J.D.H.; È.P., J.D.H. and Y.P. have been contributing with scientifically advice and discussions. All authors have contributed during the writing, editing and review of this document. All authors have read and agreed to the published version of the manuscript.

Funding

This work was supported by the EPSRC funded ORCA HUB (EP/R026173/1).

Acknowledgments

We would like to thank Yaniel Carreno and Joshua Roe for support with the simulator and the simulated environment.

Conflicts of Interest

The authors declare no conflict of interest.

Abbreviations

The following abbreviations are used in this manuscript:
ADA*anytime dynamic A*
AUVautonomous underwater vehicle
C-Spaceconfiguration space
DVLdoppler velocity log
DWAdynamic window approach
D*dynamic A*
ESTexpansive space trees
GAgenetic algorithm
HA*hybrid A*
PRMprobabilistic roadmap
ROSrobot operating system
ROVremotely operated vehicle
RRTrapid-exploring random tree
RRT*asymptotic optimal RRT
FCLFlexible Collision Library
SLAMsimultaneous localisation and mapping
SSTstable sparse-RRT

References

  1. Robb, D.; Lopes, J.; Padilla, S.; Laskov, A.; Garcia, F.J.C.; Liu, X.; Willners, J.S.; Valeyrie, N.; Lohan, K.; Lane, D.; et al. Exploring Interaction with Remote Autonomous Systems using Conversational Agents. In Proceedings of the DIS 2019—2019 ACM Designing Interactive Systems Conference, Diego, CA, USA, 23–28 June 2019; pp. 1543–1556. [Google Scholar]
  2. Sato, Y.; Maki, T.; Masuda, K.; Matsuda, T.; Sakamaki, T. Autonomous docking of hovering type AUV to seafloor charging station based on acoustic and visual sensing. In Proceedings of the 2017 IEEE OES International Symposium on Underwater Technology (UT 2017), Busan, Korea, 21–24 February 2017; pp. 1–6. [Google Scholar]
  3. LaValle, S.M. Planning Algorithms; Cambridge University Press: Cambridge, UK, 2006. [Google Scholar]
  4. Lozano-Pérez, T. Spatial Planning: A Configuration Space Approach. IEEE Trans. Comput. 1983, C-32, 108–120. [Google Scholar]
  5. Dijkstra, E. A Note on Two Problems in Connection with Graphs. Numer. Math. 1959, 1, 269–271. [Google Scholar] [CrossRef] [Green Version]
  6. Hart, P.E.; Nilsson, N.J.; Raphael, B. A Formal Basis for the Heuristic Determination of Minimum Cost Paths. Syst. Sci. Cybern. 1968, 4, 100–107. [Google Scholar] [CrossRef]
  7. Tanakitkorn, K.; Wilson, P.A.; Turnock, S.R.; Phillips, A.B. Grid-based GA path planning with improved cost function for an over-actuated hover-capable AUV. In Proceedings of the IEEE/OES Autonomous Underwater Vehicles, Oxford, MS, USA, 6–9 October 2014. [Google Scholar]
  8. 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] [Green Version]
  9. LaValle, S.M.; Kuffner, J.J. Randomized kinodynamic planning. Int. J. Robot. Res. 2001, 20, 378–400. [Google Scholar] [CrossRef]
  10. Karaman, S.; Frazzoli, E. Sampling-based algorithms for optimal motion planning. Int. J. Robot. Res. 2011, 30, 846–894. [Google Scholar] [CrossRef]
  11. Yan, Z.; Zhao, Y.; Chen, T.; Deng, C. 3D path planning for AUV based on circle searching. In Proceedings of the OCEANS 2012 MTS/IEEE: Harnessing the Power of the Ocean, Hampton Roads, VA, USA, 14–19 October 2012. [Google Scholar]
  12. Pivtoraiko, M.; Kelly, A. Generating near minimal spanning control sets for constrained motion planning in discrete state spaces. In Proceedings of the 2005 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Edmonton, AB, Canada, 2–6 August 2005; pp. 594–600. [Google Scholar]
  13. Dolgov, D.; Thrun, S.; Montemerlo, M.; Diebel, J. Practical search techniques in path planning for autonomous driving. Int. Symp. Comb. Search SoCS 2008, 1001, 18–80. [Google Scholar]
  14. Hsu, D. Randomized Single-query Motion Planning in Expansive Spaces. Ph.D. Thesis, Stanford University, Stanford, CA, USA, 2000. [Google Scholar]
  15. Phillips, J.M.; Bedrossian, N.; Kavraki, L.E. Guided expansive spaces trees: A search strategy for motion- and cost-constrained state spaces. In Proceedings of the IEEE International Conference on Robotics and Automation, New Orleans, LA, USA, 26 April–1 May 2004. [Google Scholar]
  16. Dubins, L.E. On Curves of Minimal Length with a Constraint on Average Curvature, and with Prescribed Initial and Terminal Positions and Tangents. Am. J. Math. 1957, 79, 497–516. [Google Scholar] [CrossRef]
  17. Hernández, J.D.; Vidal, E.; Moll, M.; Palomeras, N.; Carreras, M.; Kavraki, L.E. Online motion planning for unexplored underwater environments using autonomous underwater vehicles. J. Field Robot. 2019, 36, 370–396. [Google Scholar] [CrossRef]
  18. Pairet, È.; Hernández, J.D.; Lahijanian, M.; Carreras, M. Uncertainty-based Online Mapping and Motion Planning for Marine Robotics Guidance. In Proceedings of the IEEE International Conference on Intelligent Robots and Systems, Madrid, Spain, 1–5 October 2018; pp. 2367–2374. [Google Scholar]
  19. Vidal, E.; Moll, M.; Palomeras, N.; Hernández, J.D.; Carreras, M.; Kavraki, L.E. Online multilayered motion planning with dynamic constraints for autonomous underwater vehicles. In Proceedings of the IEEE International Conference on Robotics and Automation, Montreal, QC, Canada, 20–24 May 2019; pp. 8936–8942. [Google Scholar]
  20. Pairet, È.; Hernández, J.D.; Petillot, Y.; Lahijanian, M. Online Mapping and Motion Planning under Uncertainty for Safe Navigation in Unknown Environments. arXiv 2020, arXiv:2004.12317. [Google Scholar]
  21. 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, St. Johns, NL, Canada, 30 September–2 October 2020. [Google Scholar]
  22. Ferguson, D.; Stentz, A. Field D*: An interpolation-based path planner and replanner. Springer Tracts Adv. Robot. 2007, 28, 239–253. [Google Scholar]
  23. Koenig, S.; Maxim Likhachev, M. Fast replanning for navigation in unknown terrain. IEEE Trans. Robot. 2005, 21, 354–363. [Google Scholar] [CrossRef]
  24. Likhachev, M.; Ferguson, D.; Gordon, G.; Stentz, A.; Thrun, S. Anytime dynamic a*: An anytime, replanning algorithm. In Proceedings of the 15th International Conference on Automated Planning and Scheduling, Monterey, CA, USA, 5–10 June 2005; pp. 262–271. [Google Scholar]
  25. Petereit, J.; Emter, T.; Frey, C.; Kopfstedt, T.; Beutel, A. Application of Hybrid A* to an Autonomous Mobile Robot for Path Planning in Unstructured Outdoor Environments. In Proceedings of the ROBOTIK 2012—7th German Conference on Robotics, Munich, Germany, 21–22 May 2012; pp. 227–232. [Google Scholar]
  26. Dolgov, D.; Thrun, S.; Montemerlo, M.; Diebel, J. Path planning for autonomous vehicles in unknown semi-structured environments. Int. J. Robot. Res. 2010, 29, 485–501. [Google Scholar] [CrossRef]
  27. Heo, Y.J.; Chung, W.K. RRT-based path planning with kinematic constraints of AUV in underwater structured environment. In Proceedings of the 2013 10th International Conference on Ubiquitous Robots and Ambient Intelligence (URAI 2013), Jeju, Korea, 30 October–2 November 2013; pp. 523–525. [Google Scholar]
  28. Hernandez, J.D.; Vidal, E.; Vallicrosa, G.; Galceran, E.; Carreras, M. Online path planning for autonomous underwater vehicles in unknown environments. In Proceedings of the IEEE International Conference on Robotics and Automation, Seattle, WA, USA, 26–30 May 2015; pp. 1152–1157. [Google Scholar]
  29. Petillot, Y.; Ruiz, I.; Lane, D. Underwater vehicle obstacle avoidance and path planning using a multi-beam forward looking sonar. IEEE J. Ocean. Eng. 2001, 26, 240–251. [Google Scholar] [CrossRef] [Green Version]
  30. Stentz, A. Optimal and efficient path planning for unknown and dynamic environments. Int. J. Robot. Autom. 1994, 10, 89–100. [Google Scholar]
  31. Bekris, K.E.; Kavraki, L.E. Greedy but safe replanning under kinodynamic constraints. In Proceedings of the IEEE International Conference on Robotics and Automation, Roma, Italy, 10–14 April 2007; pp. 704–710. [Google Scholar]
  32. Ferguson, D.; Kalra, N.; Stentz, A. Replanning with RRTs. In Proceedings of the IEEE International Conference on Robotics and Automation, Orlando, FL, USA, 15–19 May 2006. [Google Scholar]
  33. Hernández, J.D.; Moll, M.; Vidal, E.; Carreras, M.; Kavraki, L.E. Planning feasible and safe paths online for autonomous underwater vehicles in unknown environments. In Proceedings of the IEEE International Conference on Intelligent Robots and Systems, Daejeon, Korea, 9–14 October 2016; Volume 4, pp. 214–221. [Google Scholar]
  34. Carreras, M.; Candela, C.; Ribas, D.; Palomeras, N.; Magií, L.; Mallios, A.; Vidal, E.; Pairet, È.; Ridao, P. Testing SPARUS II AUV, an Open Platform for Industrial, Scientific and Academic Applications; Instrumentation Viewpoint: Canary Islands, Spain, 2015. [Google Scholar]
  35. Carreras, M.; Hernández, J.D.; Vidal, E.; Palomeras, N.; Ribas, D.; Ridao, P. Sparus II AUV—A Hovering Vehicle for Seabed Inspection. IEEE J. Ocean. Eng. 2018, 43, 344–355. [Google Scholar] [CrossRef]
  36. Ribas, D.; Palomeras, N.; Ridao, P.; Carreras, M.; Mallios, A. Girona 500 AUV: From survey to intervention. IEEE/ASME Trans. Mechatron. 2011, 17, 46–53. [Google Scholar] [CrossRef]
  37. Russell, S.; Norvig, P. Artificial Intelligence: A Modern Approach, 3rd ed.; Prentice Hall Press: Upper Saddle River, NJ, USA, 2009. [Google Scholar]
  38. Pearl, J. Heuristics: Intelligent Search Strategies for Computer Problem Solving; Addison-Wesley Longman Publishing Co. Inc.: Boston, MA, USA, 1984. [Google Scholar]
  39. Sucan, I.A.; Moll, M.; Kavraki, L.E. The Open Motion Planning Library. IEEE Robot. Autom. Mag. 2012, 19, 72–82. [Google Scholar] [CrossRef] [Green Version]
  40. Durrant-Whyte, H.; Bailey, T. Simultaneous localization and mapping (SLAM): Part I The Essential Algorithms. Robot. Autom. Mag. 2006, 2, 99–110. [Google Scholar] [CrossRef] [Green Version]
  41. Hornung, A.; Wurm, K.M.; Bennewitz, M.; Stachniss, C.; Burgard, W. OctoMap: An efficient probabilistic 3D mapping framework based on octrees. Auton. Robot. 2013, 34, 189–206. [Google Scholar] [CrossRef] [Green Version]
  42. Pan, J.; Chitta, S.; Manocha, D. FCL: A general purpose library for collision and proximity queries. In Proceedings of the IEEE International Conference on Robotics and Automation, Saint Paul, MN, USA, 14–18 May 2012; pp. 3859–3866. [Google Scholar]
  43. Quigley, M.; Conley, K.; Gerkey, B.; Faust, J.; Foote, T.; Leibs, J.; Wheeler, R.; Ng, A.Y. ROS : An open-source Robot Operating System. IEEE Robot. Autom. 2009, 15, 19. [Google Scholar]
  44. Manhães, M.M.M.; Scherer, S.A.; Voss, M.; Douat, L.R.; Rauschenbach, T. UUV Simulator: A Gazebo-based package for underwater intervention and multi-robot simulation. In Proceedings of the OCEANS 2016 MTS/IEEE Monterey, Monterey, CA, USA, 19–23 September 2016. [Google Scholar]
  45. Cerqueira, R.; Trocoli, T.; Neves, G.; Joyeux, S.; Albiez, J.; Oliveira, L. A novel GPU-based sonar simulator for real-time applications. Comput. Graph. 2017, 68, 66–76. [Google Scholar] [CrossRef]
Figure 1. (a) A* and Dijkstra’s algorithm use discrete states in the centre of a cell. (b) State-lattice A* can connect the centre of cells using curvatures and straight lines [12]. (c) Hybrid A* (HA*) uses continuous values for states within cells instead of discrete location of states. This allows for smooth paths which can utilise a larger configuration space (C-Space) than (a,b).
Figure 1. (a) A* and Dijkstra’s algorithm use discrete states in the centre of a cell. (b) State-lattice A* can connect the centre of cells using curvatures and straight lines [12]. (c) Hybrid A* (HA*) uses continuous values for states within cells instead of discrete location of states. This allows for smooth paths which can utilise a larger configuration space (C-Space) than (a,b).
Sensors 21 01152 g001
Figure 2. A set of motion primitives in S E ( 3 ) is constructed using the kinematic model of a bicycle. This is a discrete representation of the robot’s motion capabilities. The set of motion primitives consists of 1 straight path, 10 curvatures in the horizontal plane and 4 in the vertical.
Figure 2. A set of motion primitives in S E ( 3 ) is constructed using the kinematic model of a bicycle. This is a discrete representation of the robot’s motion capabilities. The set of motion primitives consists of 1 straight path, 10 curvatures in the horizontal plane and 4 in the vertical.
Sensors 21 01152 g002
Figure 3. (a) When a state is expanding it applies a binary search to find a motion primitive which leads to the state that is closest to the goal within the set of motion primitive’s outer limits. This state should, if within the current capabilities from q e x p , have a heading towards the goal configuration. (b) A path found without using binary search. (c) Using binary search can create a path that is heading towards the goal in a straighter path, and therefore also resulting in a shorter path length.
Figure 3. (a) When a state is expanding it applies a binary search to find a motion primitive which leads to the state that is closest to the goal within the set of motion primitive’s outer limits. This state should, if within the current capabilities from q e x p , have a heading towards the goal configuration. (b) A path found without using binary search. (c) Using binary search can create a path that is heading towards the goal in a straighter path, and therefore also resulting in a shorter path length.
Sensors 21 01152 g003
Figure 4. Incremental collision check is performed by traversing the intermediate states of a branch in the motion primitives until either the end state is reached (as in ψ 2 : 6 ) or a collision is found (as in ψ 1 : 4 ).
Figure 4. Incremental collision check is performed by traversing the intermediate states of a branch in the motion primitives until either the end state is reached (as in ψ 2 : 6 ) or a collision is found (as in ψ 1 : 4 ).
Sensors 21 01152 g004
Figure 5. During operation, to compensate for errors in control and sensing, the approach inflates the sensed environment and/or the bounding box of the vehicle. The cells within the red box are added to the map used for collision detection.
Figure 5. During operation, to compensate for errors in control and sensing, the approach inflates the sensed environment and/or the bounding box of the vehicle. The cells within the red box are added to the map used for collision detection.
Sensors 21 01152 g005
Figure 6. Best viewed in colour. (a) The search tree prior to the map being updated is shown in green. With the updated map, the solution is however no longer valid as it intersects with the environment. (b) The tree in (a) is pruned from branches which are in collision with the environment, the remaining valid tree is shown in blue. The pruned tree is used to initialise the search to find a new solution. The new explored tree required to find a new solution is shown in green.
Figure 6. Best viewed in colour. (a) The search tree prior to the map being updated is shown in green. With the updated map, the solution is however no longer valid as it intersects with the environment. (b) The tree in (a) is pruned from branches which are in collision with the environment, the remaining valid tree is shown in blue. The pruned tree is used to initialise the search to find a new solution. The new explored tree required to find a new solution is shown in green.
Sensors 21 01152 g006
Figure 7. The three known scenarios used to compare our HA* implementation to state-lattice A*, RRT and Dubins-RRT*. The figures include the solution of HA* (The path of intermediate states in blue with green arrows for the configurations of the states). The red sphere shows the start of the query. The yellow sphere is the goal region. (a) Scenario 1: Gap. (b) Scenario 2: Canyon. (c) Scenario 3: Cave (Dead-end).
Figure 7. The three known scenarios used to compare our HA* implementation to state-lattice A*, RRT and Dubins-RRT*. The figures include the solution of HA* (The path of intermediate states in blue with green arrows for the configurations of the states). The red sphere shows the start of the query. The yellow sphere is the goal region. (a) Scenario 1: Gap. (b) Scenario 2: Canyon. (c) Scenario 3: Cave (Dead-end).
Sensors 21 01152 g007
Figure 8. The 4 simulated scenarios. (a) Scenario 1: offshore structures. (b) Scenario 2: circle/narrow exit. (c) Scenario 3: corridor. (d) Scenario 4: incident/cluttered. (ac) The OctoMap constructed from the data of the forward looking sonar throughout the execution of the plan (red trajectory). (d) Shows the Gazebo world using the UUV Simulator, where the robot needs to navigate in a cluttered environment through fallen wind turbines, pillars and other offshore structures. The robot is depicted at the end of the query in all of the images.
Figure 8. The 4 simulated scenarios. (a) Scenario 1: offshore structures. (b) Scenario 2: circle/narrow exit. (c) Scenario 3: corridor. (d) Scenario 4: incident/cluttered. (ac) The OctoMap constructed from the data of the forward looking sonar throughout the execution of the plan (red trajectory). (d) Shows the Gazebo world using the UUV Simulator, where the robot needs to navigate in a cluttered environment through fallen wind turbines, pillars and other offshore structures. The robot is depicted at the end of the query in all of the images.
Sensors 21 01152 g008
Figure 9. A comparison between our proposed approach for replanning using a pruned tree with HA* compared to HA* replanning from a single root node. Our approach reduces the time spent planning in all considered scenarios. The start position of the robot and the goal are presented, for each scenario, above the corresponding graph. (a) Scenario 1: offshore structures. (b) Scenario 2: circle/narrow exit. (c) Scenario 3: corridor. (d) Scenario 4: incident/cluttered. (e) Legend to describe the graphs.
Figure 9. A comparison between our proposed approach for replanning using a pruned tree with HA* compared to HA* replanning from a single root node. Our approach reduces the time spent planning in all considered scenarios. The start position of the robot and the goal are presented, for each scenario, above the corresponding graph. (a) Scenario 1: offshore structures. (b) Scenario 2: circle/narrow exit. (c) Scenario 3: corridor. (d) Scenario 4: incident/cluttered. (e) Legend to describe the graphs.
Sensors 21 01152 g009
Table 1. Comparison of related work based on the dimension of the C-Space, inclusion of kinematic constraints, suitability for online planning, replanning capabilities in unknown environments and applicability for autonomous underwater vehicles (AUVs). Approaches without replanning capabilities discard their current plan and start the search for a new path without using any prior obtained knowledge about the search-space. The values in bold highlight the desired characteristics for online path planning for a non-holonomic AUV in an unknown 3D environment. a Projects the 3D map to 2D to plan in S E ( 2 ) . b  Assumes hovering capabilities for the vehicle.
Table 1. Comparison of related work based on the dimension of the C-Space, inclusion of kinematic constraints, suitability for online planning, replanning capabilities in unknown environments and applicability for autonomous underwater vehicles (AUVs). Approaches without replanning capabilities discard their current plan and start the search for a new path without using any prior obtained knowledge about the search-space. The values in bold highlight the desired characteristics for online path planning for a non-holonomic AUV in an unknown 3D environment. a Projects the 3D map to 2D to plan in S E ( 2 ) . b  Assumes hovering capabilities for the vehicle.
MethodReferenceC-SpaceKinematic ConstraintsOnlineReplanningAUV
Search-based
Field-D*/D*-lite[22,23] R 2 NoYesYesNo
anytime dynamic A*[24] R 2 NoYesYesNo
HA*[13,25,26] S E ( 2 ) YesYesNoNo
State-Lattice A*[12] S E ( 2 ) YesYesNoNo
A*[11]SE(3) a YesNoNoYes
HA*This paperSE(3)YesYesYesYes
Sampling-based
RRT[27] S E ( 2 ) YesYesNoYes
RRT*[28] S E ( 2 ) YesYesYesYes
RRT*[17]SE(3) b YesYesYesYes
SST[18] S E ( 2 ) YesYesNoYes
RRT*+SST[19] S E ( 2 ) YesYesNoYes
RRT*+SST[20]SE(3) b YesYesNoYes
RRT*+DWA[21]SE(2)YesYesNoYes
Other
Non-Lin. Prog.[29] S E ( 2 ) YesYesNoYes
GA[7] R 2 NoNoNoYes
Table 2. Comparison between our presented HA*, state-lattice A*, RRT and RRT* with Dubins curves. The results for the sampling-based approaches are based on 1000 executions. b Sampling region forcing the path to go through the gap. a Planning time is the average time for RRT to find a solution, allowing planning until one is found in each instance.
Table 2. Comparison between our presented HA*, state-lattice A*, RRT and RRT* with Dubins curves. The results for the sampling-based approaches are based on 1000 executions. b Sampling region forcing the path to go through the gap. a Planning time is the average time for RRT to find a solution, allowing planning until one is found in each instance.
Solution Length [m]
#MethodPlanning Time [s]MeanMedianMinMaxSuccess Rate
Scenario 1: Gap
1.1HA*0.14766.00---1.0
1.2State-Lattice A*0.45058992.5619---1.0
1.3RRT*0.14799.7099.3870.48119.350.953
1.4RRT a 0.019135.54130.4385.15248.931.0
1.5RRT*0.02135.54131.1380.34243.221.0
1.6RRT* b 0.14777.8175.3667.15102.610.089
1.7RRT b 0.147134.71130.9869.57270.030.511
1.8RRT* b 0.3077.1274.8467.62101.700.177
1.9RRT* b 1.0076.1073.3366.8891.900.383
1.10RRT b 0.12133.79129.7970.20231.840.464
1.11RRT a , b 0.26142.98139.8769.26280.851.0
Scenario 2: Canyon
2.1HA*0.00945963.00---1.0
2.2State-Lattice A*0.01321469.84---1.0
#MethodPlanning Time [s]MeanMedianMinMaxSuccess Rate
2.3RRT*0.00945981.0473.7362.71123.320.106
2.4RRT0.009459111.75108.5064.28249.340.429
2.5RRT a 0.01387122.94119.0564.617245.571.0
2.6RRT*0.2079.4572.1263.44118.830.989
Scenario 3: Cave (Dead-end)
3.1HA*0.00498518.00---1.0
3.2State-Lattice A*No SolutionNo Solution---0.0
3.3RRT*0.00519.1719.1719.1719.170.001
3.4RRT*0.0118.9919.0518.2719.530.01
3.5RRT*0.0218.9018.7617.5621.550.067
3.6RRT*0.1019.2219.1717.5622.780.978
3.7RRT0.00519.0119.0018.6419.530.005
3.8RRT0.0219.2919.1717.6822.610.106
3.9RRT a 0.03519.5019.3617.5231.451.0
Publisher’s Note: MDPI stays neutral with regard to jurisdictional claims in published maps and institutional affiliations.

Share and Cite

MDPI and ACS Style

Scharff Willners, J.; Gonzalez-Adell, D.; Hernández, J.D.; Pairet, È.; Petillot, Y. Online 3-Dimensional Path Planning with Kinematic Constraints in Unknown Environments Using Hybrid A* with Tree Pruning. Sensors 2021, 21, 1152. https://doi.org/10.3390/s21041152

AMA Style

Scharff Willners J, Gonzalez-Adell D, Hernández JD, Pairet È, Petillot Y. Online 3-Dimensional Path Planning with Kinematic Constraints in Unknown Environments Using Hybrid A* with Tree Pruning. Sensors. 2021; 21(4):1152. https://doi.org/10.3390/s21041152

Chicago/Turabian Style

Scharff Willners, Jonatan, Daniel Gonzalez-Adell, Juan David Hernández, Èric Pairet, and Yvan Petillot. 2021. "Online 3-Dimensional Path Planning with Kinematic Constraints in Unknown Environments Using Hybrid A* with Tree Pruning" Sensors 21, no. 4: 1152. https://doi.org/10.3390/s21041152

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