Next Article in Journal
Programmable Data Plane Applications in 5G and Beyond Architectures: A Systematic Review
Previous Article in Journal
Customized Trajectory Optimization and Compliant Tracking Control for Passive Upper Limb Rehabilitation
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

A Hierarchical Motion Planning Method for Mobile Manipulator

State Key Laboratory of Robotics and Systems, Harbin Institute of Technology, Harbin 150001, China
*
Authors to whom correspondence should be addressed.
Sensors 2023, 23(15), 6952; https://doi.org/10.3390/s23156952
Submission received: 7 July 2023 / Revised: 31 July 2023 / Accepted: 3 August 2023 / Published: 4 August 2023
(This article belongs to the Section Sensors and Robotics)

Abstract

:
This paper focuses on motion planning for mobile manipulators, which includes planning for both the mobile base and the manipulator. A hierarchical motion planner is proposed that allows the manipulator to change its configuration autonomously in real time as needed. The planner has two levels: global planning for the mobile base in two dimensions and local planning for both the mobile base and the manipulator in three dimensions. The planner first generates a path for the mobile base using an optimized A* algorithm. As the mobile base moves along the path with the manipulator configuration unchanged, potential collisions between the manipulator and the environment are checked using the environment data obtained from the on-board sensors. If the current manipulator configuration is in a potential collision, a new manipulator configuration is searched. A sampling-based heuristic algorithm is used to effectively find a collision-free configuration for the manipulator. The experimental results in simulation environments proved that our heuristic sampling-based algorithm outperforms the conservative random sampling-based method in terms of computation time, percentage of successful attempts, and the quality of the generated configuration. Compared with traditional methods, our motion planning method could deal with 3D obstacles, avoid large memory requirements, and does not require a long time to generate a global plan.

1. Introduction

A mobile manipulator consists of a mobile base and one (or more) traditional manipulators [1,2]. It integrates the advantages of both mobile robots and fixed-base manipulators. With the increased degrees of freedom provided by the mobile base, mobile manipulators could expand their workspace to a large area while maintaining the ability of dexterous manipulation of the manipulator.
At an early stage, most of the work focused on the problem of motion coordination between the mobile base and the manipulator [3,4,5]. Motion planning for mobile manipulators in this paper could be defined as determining a collision-free path from a given start configuration to a desired goal configuration. There are roughly two types of approaches to the problem. One of them is to consider the mobile manipulator as two subsystems and plan separately for the mobile base and the manipulator, the other one is to consider the whole mobile manipulator as a single system with high degrees of freedom. Separate planning for the mobile base and manipulator is relatively straightforward, various planning algorithms can be used for the mobile base [6,7] and the manipulator. Castaman et al. proposed an algorithm called Receding Horizon Task and Motion Planning (RH-TAMP), which used RRT-Connect for the manipulator planning and used Djikstra’s algorithm for the mobile base planning [8]. Saoji et al. used RRT-Connect to plan for both the mobile base and the manipulator while the planning was carried out separately [9]. Rastegarpanah et al. used the A* algorithm to plan for the mobile base and the RRT algorithm to plan for the manipulator [10]. Obviously, this type of method has a limitation, the manipulator could collide with the environment while the mobile base moves along the generated path because the effect of the environment on the manipulator along the path is ignored. Considering the influence of the environment, it seems to be a better choice to consider the whole mobile manipulator as a combined system with high DOF. In the simplest case, a very conservative approach is to plan for a 2D projected footprint of the mobile manipulator in a projected 2D representation of the world from the start base pose to the goal base pose while the manipulator only maintains a safe configuration [11]. The limitation of this type of methods is that the manipulator may extend the footprint of the robot which makes it difficult to find an available path since a footprint may be in collision with the 2D projected map while the mobile manipulator is collision-free in the 3D environment. Some researchers [12,13] considered motion planning as a trajectory optimization problem and proposed STOMP and CHOMP, where the goal is to find suitable trajectories that minimize a given cost function without violating the given constraints. Some researchers use sampling-based planners such as RRT [14], PRM [15], their variants RRT-Connect [16], RRT* [17], Bidirectional RRT* [18], and Informed RRT* [19] for mobile manipulator motion planning due to their ability to plan in high-dimensional space. The sampling-based planners could find solutions, but the path quality could be low due to the randomness associated with sampling-based algorithms even after post-processing. These methods [20,21] require a full 3D map of the environment, which is computationally expensive, and the map needs to be updated when the environment changes. Similarly, method [22] uses the potential field function to find a path through the free space represented as a swept volume, which is even more difficult to compute explicitly.
In most cases, the mobile manipulator does not need to change the configuration of its manipulator continuously while the mobile base moves, the manipulator only needs to change its configuration at certain base poses. With this idea of adaptive dimensionality, some methods have been proposed that consider the behavioral difference between the mobile base and the manipulator with better performance. Gochev et al. [23] have proposed a method for mobile manipulator motion planning where planning in high dimension is performed only when planning in low dimension could not find an available path. Pilania and Gupta proposed the Hierarchical and Adaptive Mobile Manipulator Planner (HAMP) [24]. The planner first plans the mobile base path using PRM and then checks the collision between the manipulator and the environment for each edge along the path, if a collision is found, the manipulator changes its configuration by building a manipulator PRM. These methods ease the workload of planning in high-dimensional spaces but still need to plan in high dimension and still suffer from the long time consumed in computing a feasible path. Moreover, to generate a global plan for a mobile manipulator, a complete 3D map of the environment must be given to the planner first. Another planner with adaptive planning dimension called Optimized Hierarchical Mobile Manipulator Planner (OHMP) was proposed by Li et al. [25]. A path for mobile base was first planned with PRM, then at each mobile base node, if the manipulator was in collision with the environment, the manipulator should change to a safe configuration. The collision checking for the manipulator was performed using a 2D projection of the manipulator on the ground, which is much faster than checking in 3D maps. The disadvantage of this method is that if the manipulator is not a planar manipulator, the collision checking on 2D maps could not ensure that the manipulator would not collide with the 3D environment.
Our approach adopts the idea of adaptive dimensionality. Planning for manipulator motion is conducted only when a potential collision between manipulator and environment is found. To avoid expensive computation of planning in high-dimension, our approach does not plan a global path for both the mobile base and the manipulator with a full 3D map of the environment, as some methods do [22,23]. In our approach, a full 2D map of the environment is needed to generate a global path for the mobile base, then a potential collision checking between the manipulator and the environment is performed while the mobile base is moving, if a potential collision is found, a safe configuration for the manipulator would be found. Like OHMP [24], our approach uses the 2D projection of the manipulator for potential collision checking and safe configuration generation, the difference is that our approach projects the manipulator onto the front plane of the mobile manipulator instead of the ground, which is suitable for manipulators that are not planar manipulators. Compared with similar methods [22,23,24], our method does not use a full 3D map of the environment and does not suffer from long time-consuming planning in high dimensions, but has better performance and efficiency in crossing door-type scenes.
In this paper, we divide the motion planning for mobile manipulators into two layers. In the first layer, the path planning for the mobile base is performed, which mainly focused on moving the robot in a large area. The second layer mainly focuses on motion planning for the manipulator to avoid collision. Our contribution is to propose hierarchical motion planning for the mobile manipulator and the sampling-based heuristic manipulator planning.
The rest of this paper is organized as follows. Section 2 defines the general problem and the parameters used in the paper. Section 3 describes the motion planning algorithm. Simulation results and discussions are given in Section 4. Finally, the conclusions are given in Section 5.

2. Problem Formulation

The parameters used in this paper are defined below, and then the problem is formally formulated.
  • C b m , the configuration space of the mobile manipulator
  • C b , the configuration space of the mobile base
  • C m , the configuration space of the manipulator
  • C b f r e e , the set of all collision-free base poses
  • C b o b s , the set of all poses resulting in the collision with obstacles
  • C m f r e e , for a given base pose, C m f r e e is the set of all collision-free manipulator configurations
  • C m o b s , for a given base pose, C m o b s is the set of all configurations that are in collision with obstacles
  • q i b = [ x , y , φ ] , the pose of mobile base
  • q i m = [ θ 1 , θ 2 , , θ d ] , the configuration of the manipulator of d DOF
  • q i = ( q i b , q i m ) , the i t h configuration of the mobile manipulator
  • q s = ( q s b , q s m ) , the starting configuration of the mobile manipulator
  • q g = ( q g b , q g m ) , the goal configuration of the mobile manipulator
  • Q = { q s b , q 1 b , q n b , q g b } , the path of the mobile base
For our motion planning method, the 2D environment of the mobile base is assumed to be given or acquired by previous sensing. The environment information in front of the robot is captured in real time by a depth camera mounted on the mobile manipulator. Given the 2D map of the environment, the environment information in front of the robot, the start configuration q s = ( q s b , q s m ) C b m , and the goal configuration q g = ( q g b , q g m ) C b m of the mobile manipulator, the goal of our method is to find a collision-free path consisting of a set of mobile manipulator configuration q i = ( q i b , q i m ) C b m for the mobile manipulator. The path in our method can be expressed as
Π b m = { ( q s b , π s m ) , ( q 1 b , π 1 m ) , , ( q n b , π n m ) , ( q g b , π g m ) } .
Such a specific mobile manipulator path is called an H-path in HAMP [24]. An H-path consists of a set of mobile base poses q i b = ( x , y , φ ) C b f r e e , and for each base pose, there is a corresponding manipulator reconfiguration path π j m . Each manipulator path π j m is a set of manipulator configurations. Although the path expression used here is the same as that used in HAMP, the planning method is completely different. In HAMP, the entire path is generated at once, but in our method, the path is generated gradually, which is finally determined when the mobile manipulator arrives at the target. It is worth noting that, in most cases, the element in Π b m , ( q s b , π s m ) can be simplified as ( q i b , q i m ) , since the manipulator does not need to change its configuration. Only when a potential collision between the manipulator and the environment is found, a safe configuration of the manipulator would be sought, and a reconfiguration path would need to be generated. In our method, a collision-free global path Q consisting of a set of base configurations q i b = ( x , y , φ ) C b f r e e is first planned for the mobile base, at which time the entire path can be expressed as Π b m = { ( q s b , q s m ) , ( q 1 b , q s m ) , , ( q n b , q s m ) , ( q g b , q s m ) } . Second, while the mobile base moves along the path, collision checking for the manipulator is executed frequently, when a potential collision is found at q i b , a new collision-free configuration of the manipulator q i m = ( θ 1 , θ 2 , θ 3 , θ 4 , θ 5 , θ 6 , θ 7 ) C m f r e e would be found, then a path π i m for manipulator reconfiguration would be generated, and the element in the path ( q i b , q i m ) Π b m is updated to ( q i b , π i m ) . There are two steps of mobile manipulator movement from ( q i b , π i m ) to ( q j b , q j m ) ; at q i b , the manipulator moves along π i m to change to the last configuration q j m in π i m , then the mobile base moves from q i b to q j b with the new manipulator configuration. Finally, when the mobile manipulator arrives at the target configuration, the entire H-path Π b m is fully incrementally determined.

3. Methods

In this section, we will discuss the overall motion planning problem for mobile manipulators.
Global planning of a mobile manipulator directly in a 3D environment requires not only a complete 3D map but also a large amount of memory and a long computation time. In most cases, the manipulator does not need to continuously change its configuration while the mobile base is moving. Considering that the mobile base and the manipulator have different motion characteristics, in the movement from one initial configuration to another target configuration, the long-range movement of the mobile base is the main action that the manipulator needs to cooperate with to avoid collision with the environment. Therefore, we adopt the idea of adaptive dimensionality and perform high-dimensional planning for the manipulator only when necessary and propose a hierarchical motion planning approach that performs global planning for the mobile base at the global planning level and adjusts the manipulator’s configuration as needed while controlling the mobile base motion at the local planning level. At the local planning level, to improve computational efficiency, we use a planar projection in front of the mobile manipulator perpendicular to the ground to detect potential collisions between the manipulator and the environment and determine whether the manipulator needs reconfiguration, based on which we propose a sampling-based heuristic to efficiently generate a collision-free safe configuration. Since this collision detection method and configuration generation method can only ensure that the robot does not collide with its environment directly in front of it, and the robot needs to ensure a straight line forward, a local planner very similar to FTC [26] is used in mobile base control to separate the rotational motion from the straight-line motion to ensure that it does not collide with the environment while moving forward. At the global planning level, an optimized A* planner is used to perform global path planning for the mobile base in order to facilitate the FTC planner to track the path, reducing the curves and simplifying the path.
The structure of our Hierarchical Motion Planning for mobile manipulators is shown in Figure 1. The planner is divided into two levels. At the global planning level, an optimized A* algorithm is implemented to generate a global path for the mobile base assuming that the 2D map of the environment is known or acquired by previous sensing with a lidar. At the level of local planning, a modified FTC planner is used here to control the mobile base to move precisely along the global path, as for the manipulator, a potential collision checking is performed continuously with environment information gathered with sensors onboard, a new collision-free configuration for the manipulator would be searched and a reconfiguration path would be generated if a potential collision is found. Then the control signal for both the mobile base and the manipulator is calculated and sent to the robot so that the robot can continue to move to the target configuration. If local planning fails because there is no available path for the manipulator or the path of the mobile base is blocked, global planning would be called to re-plan a new global path with an updated 2D map.
We now describe our hierarchical motion planning (HMP) algorithm in detail explained in Algorithm 1.
In the first stage, a routine PLANBASEPATH() is called to plan an initial global path for the mobile base using an optimized A* algorithm, the pseudocode for which is shown in Algorithm 2. The path planning for the mobile base is carried out on a 2D grid map. The 2D map can be constructed in advance using the gmapping algorithm [27] and the map is considered as the robot’s prior knowledge. Given the start and target configuration of the mobile base, an initial path of the mobile base is searched by A* algorithms [28]. The mobile base is simplified as a circle with a flattened radius to avoid collision with obstacles.
A cutting method is used here to optimize the path generated by A* algorithm (Lines 3–17, Algorithm 2). The main idea of this method is to reduce the number of curves in the path and make it easier for the mobile base to move along. The path Q o r i g i n generated by A* algorithm has n elements q i b C b f r e e , the first element is q s b and the last element is q g b . The initial values of qprune and qtarget are q s b and q g b . The algorithm has two loops. In the inner loop, for each iteration, try to connect qprune and qtarget with a line, if the line is not in collision with environment obstacles, those q i b between them could be removed and the path is simplified, otherwise set qtarget as the qtarget-1 until qtarget is next to qprune. In the outer loop, set qprune as qtarget and set qtarget as qend, the algorithm goes into the inner loop until qprune is q g b . If there is no available path planned, routine PLANBASEPATH() returns failure.
As shown in Figure 2, the two paths in Figure 2a are the original results generated by A* algorithm, and the two paths in Figure 2b are the optimized paths. It is obvious that the number of curves in each path decreased after optimization. Moreover, the shape of the path generated by the optimized A* algorithm is much more suitable for the mobile base to track with the local planner which will be introduced later.
Algorithm 1:  Π b m = HMP ( q s , q g )
  Input:  q s : = ( q s b , q s m ) ,   q g : = ( q g b , q g m )
  Output:   H-path : Π b m   from   q s   to   q g
1    Q : = PLANBASEPATH ( q s b , q g b )
2    Augment   Π   b m   with   mobile   base   path   Q ,   and   reconfiguration   path   π i m : = ,   specially ,   π s m : = q s m
3    if   Q   do
4             for   all   q i b Q   do
5                   if   BASECOLLISIONFREE ( q i + 1 b )   then
6                         if   q i + 1 b = q g b   then
7                               if   MANIPCOLLISIONFREE ( q g m )   then
8                                     π i m : = GENERATEMANIPPATH ( q c m )  
9                                     π i b m ( q i b , π i m ) ,   π i b m Π b m
10                                      MOVEMANIP ( π i m )
11                                      MOVEBASE ( q i b , q i + 1 b )
12                                      Exit   ( go   to   step   32 )
13                               end
14                          end
15                          ( q n e w m , π i m ) : = PLANMANIPPATH ( q c m )
16                          if   π i m   then
17                                MOVEMANIP ( π i m )
18                                MOVEBASE ( q i b , q i + 1 b )
19                                π i b m ( q i b , π i m ) ,   π i b m Π b m
20                         end
21                         else
22                                     Q : = REPLANBASEPATH ( q i b , q g b , Q )
23                                     Continue   ( go   to   step   4 )
24                         end
25                 end
26                 else
27                        Q : = REPLANBASEPATH ( q i b , q g b , Q )
28                        Continue   ( go   to   step   4 )
29             end
30        end
31  end
32  return   Π b m
Algorithm 2:    Q = PLANBASEPATH ( q s b , q g b )
         Input:  q s b : = [ x s , y s , φ s ] ,   q g b : = [ x g , y g , φ g ]
         Output:   Base   path : Q   from   q s b   to   q g b
1       Q o r i g i n : = PLANBASEPATHASTAR ( q s b , q g b )
2       if   Q o r i g i n   do
3       q p r u n e q s b : = [ x s , y s , θ s ]
4              while   ! q p r u n e = q g b   do
5                   q t a r g e t q g b : = [ x g , y g , θ g ]
6                   while   p r u e n + 1 < t a r g e t   do
7                         if   COLLISIONFREE ( q p r u n e , q t a r g e t )   then
8                               Remove   q j ( p r u n e < j < t a r g e t )   from   Q o r i g i n
9                               Break   ( go   to   step   15 )
10                       end
11                       else
12                               q t a r g e t q t a r g e t - 1
13                         end
14                   end
15                   q p r u n e q t a r g e t
16             end
17     end
18     return   Q o r i g i n
For the second stage, we augment the full path Π b m so that each element π i b m has a base pose q i b and a reconfiguration path π i m . Note that the full path is constructed incrementally as the mobile manipulator moves from start to target.
The second stage described in Lines 3–32 of Algorithm 1 is mainly about local planning. If routine PLANBASEPATH() returns success as shown by the check in Line 3, the mobile base would start moving along the generated path. Otherwise, there is no path available for the mobile base and the motion planning fails. A potential collision checking routine BASECOLLISIONFREE() for the mobile base is used here to check whether the mobile base could move to the next base pose (Line 5). The collision checking for the mobile base can be easily performed using information collected by an onboard sensor such as a lidar. If routine BASECOLLISIONFREE() returns a failure, a replanning routine REPLANBASEPATH()-is called to replan a new Q for the mobile base with the updated map, as shown in Algorithm 3. The path from current q i b to target q g b is changed and the mobile base would then follow the new path. If no potential collision is found, the mobile base would try to move to the next base pose. There is a special case, if q i + 1 b = q g b , the mobile base is about to arrive at the target base pose, the manipulator should change its configuration to the target configuration (Lines 6–11). A routine MANIPCOLLISIONFREE() is used here to check whether the manipulator configuration is collision-free with the environment while the mobile base moving straight to the next pose. If routine MANIPCOLLISIONFREE() returns a success, a reconfiguration path π i m would be generated by routine GENERATEMANIPPATH(). Here a simple cubic polynomial trajectory is generated. Π b m is updated and the motion planning for the mobile manipulator is finally successfully completed. Routine MOVEMANIP() and MOVEBASE() send control signals to the robot. Here, the planner for mobile base is similar to FTC planner [26], where moving straight and rotating are performed in sequence. Here, the mobile base first moves straight to the next position and then rotate to the corresponding direction, which is suitable for the path generated by optimized A*. In most cases, q i + 1 b q g b , routine PLANMANIPPATH() would search for a collision-free configuration and a corresponding reconfiguration path for the manipulator. If routine PLANMANIPPATH() returns a success as shown by the check on Line 16, the mobile manipulator simply moves forward, changing its configuration if necessary, and the Π b m is updated. On the other hand, if there is no available configuration or reconfiguration path that could make it feasible for the mobile manipulator to move on, REPLANBASEPATH() is called to replan a new path for the mobile base. This process is repeated until the mobile manipulator arrives at the target or the algorithm fails.
The pseudocode for PLANMANIPPATH() is shown in Algorithm 4 which is very important for our motion planning method. We will now describe the algorithm in detail. PLANMANIPPATH() routine works as follows: first, it checks whether the current configuration of the manipulator is collision-free with routine MANIPCOLLISIONFREE(). If it is, the safe configuration can be the same as the current configuration and the returned manipulator path is that single configuration. Otherwise, a new safe configuration and corresponding reconfiguration path would be searched (Lines 6–22).
Algorithm 3:  Q = REPLANBASEPATH ( q n s b , q g b , Q )
                     q n s b : = [ x n s , y n s , φ n s ] , q n s b Q ,
         Input:  q g b : = [ x g , y g , φ g ] , Q : = { q s b , q 1 b , q n b , q g b }
         Output:  New   base   path : Q   from   q s b   to   q g b
1       Q n e w = PLANBASEPATH ( q n s b , q g b )
2       Remove   q n ( n s < n g )   from   Q
3       Add   all   q j Q n e w   to   Q
4       return   Q
Algorithm 4:  ( q n e w m , π i m ) : = PLANMANIPPATH ( q c m )
        Input:  q c m : = [ θ 1 , θ 2 , , θ d ]
                       Collision - free   configuration :   q n e w m
        Output:  Reconfiguration   path : π i m
1       if   MANIPCOLLISIONFREE ( q c m )   then
2             q s a m p m     q c m  
3             π i m     q c m  
4             Exit   ( go   to   step   24 )
5       end
6       q t e m p m : = MATCHTEMPLATE ( )  
7       q s a m p m q t e m p m
8       π i m  
9       if   q t e m p m   do
10             while   ! TIMEUP   do
11                  if   MANIPCOLLISIONFREE ( q s a m p m )   then
12                       π i m : = GENERATEMANIPPATH ( q s a m p m )  
13                       Exit   ( go   to   step   24 )
14                    end
15                    for   all   θ i t q t e m p m   do
16                       Sample   θ i s   around   θ i t q t e m p m
17                    end
18                    q s a m p m : = [ θ 1 s , θ 2 s , , θ d s ]
19               end
20               q s a m p m  
21               π i m  
22       end
23       return   ( q s a m p m , π i m )
Routine MANIPCOLLISIONFREE() uses point cloud information obtained by the onboard depth camera to check if there is a potential collision between the manipulator and the environment with unchanged configuration as the mobile base moves forward. Different from the 3D collision checking in a 3D map, we use the 2D projection of the manipulator and the 2D projection of the environment in front of the robot to perform the collision checking. Since the mobile base only moves forward in a straight line, this method can detect potential collisions at a small distance and is suitable for door-type scenes. The point cloud obtained from the camera is processed by clipping, filtering, formulating, and then compressed into a plane as shown in Figure 3a. The collision checking is conducted with the point cloud. As for the manipulator, we use bounding balls as shown in Figure 3b. to represent the collision volume of the manipulator, which can be easily projected onto a plane. We select N bounding balls for collision checking. For BALLn (nN), the coordinate of the ball center in the ith link frame of the manipulator is:
C b n i = x b n i ,   y b n i ,   z b n i .
For a given configuration q i m = ( θ 1 , θ 2 , θ 3 , θ 4 , θ 5 , θ 6 , θ 7 ) , the angle of each manipulator joint is known. The coordinate of the center of each bounding ball in the base frame can be calculated:
C b n 0 = x b n 0 ,   y b n 0 , z b n 0 T =   0 T i · x b n i ,   y b n i ,   z b n i T .
  0 T i is the transformation matrix from link i to the base.
For each point in the point cloud, the coordinate in the base frame is:
P k 0 = x k 0 ,   y k 0 ,   z k 0 .
For the collision checking, only the coordinates on the y-axis and z-axis are used, the coordinate on the x-axis is eliminated. The distance between the point and the center of the bounding ball is:
L b n , k 0 = ( y b n 0 + z b n 0 ) 2 + ( y k 0 + z k 0 ) 2 .
The collision checking is shown in Figure 3c. If the distance between the point cloud and the center of the bounding ball is less than the radius of the bounding ball, it is defined that the bounding ball is not in collision with the point. If each bounding ball is not in collision with each point of the point cloud, the manipulator is not in collision with the environment, which means that the current configuration is suitable for the next period of the path.
If a collision is found, the manipulator should change its configuration. Another part of routine PLANMANIPPATH() is the search for a collision-free configuration and the corresponding reconfiguration path (Lines 6–22). The path can be generated by GENERATEMANIPPATH(), which was described earlier, here we proposed a sampling-based heuristic method to find the collision-free configuration.
There are several typical collision-free configurations corresponding to several typical scenes. Looking from the front, we can roughly classify the scene into six types, and we can find the corresponding configuration for the manipulator as shown in Figure 4.
The point cloud used in routine MATCHTEMPLATE() is the same as that used in Routine MANIPCOLLISIONFREE(). The routine analyzes the point cloud and finds the template that most closely matches the point cloud. We divide the whole point cloud into nine regions and count the number of points in each region. The number of points indicates how much of the area is occupied and how likely it is to find a configuration that uses the area. A threshold is chosen for each area, numbers above the threshold mean that it is hard to find a configuration that uses that area without collision and the configuration should avoid that area. According to the complexity of each configuration, each configuration has a priority.
As shown in Figure 5, area 2 must be free otherwise the base of the manipulator cannot change its configuration at all. If this area is occupied, q t e m p m = would be returned. If possible, the configuration using area 2 and 1 should be chosen first, which corresponds to Figure 4a, because it is the normal configuration for the manipulator and has the best stability among all configurations in templates. The situation of area 1 should be checked first. If area 1 is occupied, the situation of area 3 and area 4 is checked at the same time. The configuration corresponding to area 3 and area 4 are shown in Figure 4b,e. The configuration corresponding to areas 5 and 6 are shown in Figure 4c,f, The center of gravity in Figure 4b,e are closer to the center of the mobile base than that in Figure 4c,f. Of course, if area 3 and area 4 are both unavailable, area 5 and area 6 are checked. If both area 5 and area 6 are occupied, the robot has only one choice as shown in Figure 4d. After analyzing all areas, a template that is most similar to the environment would be selected. It is also possible that all areas are occupied, in which case q t e m p m = is returned. After finding the most similar template, all joint angles of the corresponding configuration are known.
A sampling-based method is used to generate the collision-free configuration (Lines 10–19). Each angle is sampled in the selected range near the corresponding angle of the template configuration. The rule of range selection is to make it possible to sample more types of configurations suitable for similar environmental situations. In general, the ranges of the first four angles are relatively more important and should be selected very carefully. As shown in Figure 6a,c,e are template configurations, and b and d are generated configurations with sampling around template Figure 6c. A suitable sampling range of joints could generate a good configuration for variants of the template scene. Meanwhile, selecting a suitable sampling range does not destroy the diversity of configuration, as seen in Figure 6, with the value of the first four joints changing gradually, the template configuration in Figure 6c could change to the template configuration in Figure 6a,e. Thus, if the sampling range is well selected, almost all configurations for passing different shapes of scenes could possibly be generated with one of the templates. This method could improve the success rate of sampling and save sampling time. Then, routine MANIPCOLLISIONFREE() checks whether the sampled configuration is collision free. If it is collision-free, routine GENERATEMANIPPATH() would generate a reconfiguration path and the routine PLANMANIPPATH() would return ( q s a m p m , π i m ) . If a collision is found, another sample is taken, the collision checking is performed, and the process is repeated until a collision-free configuration is found, or the plan time is used up. Our sampling-based heuristic method avoids strange configurations caused by the randomness of the sampling-based method and has better performance with a smaller range of sampling.

4. Experiments and Discussion

In this section, we have conducted a series of simulation experiments to evaluate our algorithm. The mobile manipulator in the experiments consists of a differential-drive mobile base and a seven-axis manipulator. A depth camera and a planar lidar are also added to the robot. We import a complete model of the mobile manipulator into ROS [29]. The simulation environment for the experiments is Gazebo which can simulate the real physical properties of the robot and the environment.
The overall planner is written in C++ and works as a node of ROS. The simulation experiments were carried out under Linux on an Intel Core laptop with 16 GB memory.
At first, we validated the effectiveness of the configuration-generating part of our method which is routine PLANMANIPPATH(), since routine GENERATEMANIPPATH() was simple, we ran sampling-based heuristic method and random sampling method of generating collision-free configuration in four different scenarios in simulation and compared the outcomes. In both methods, routine MANIPCOLLISIONFREE() was used to check whether the configuration is collision-free with the environment. In addition, self-collision checking is added to both methods to avoid possible self-collision of the manipulator. Similar to routine MANIPCOLLISIONFREE(), here bounding balls are used to represent the volume of the manipulator, and the collision checking between bounding balls is performed in 3D with the same method as described in routine MANIPCOLLISIONFREE(). The simulation environment corresponding to each scenario is shown in Figure 7, column (b) while the point cloud used in the collision checking is shown in column (a). The mobile manipulator was placed in front of each obstacle and the configuration-generating algorithm was run. We compared the sampling-base heuristic method with the random sampling method on the basis of three criteria: (a) number of sampling times, (b) sampling time, (c) percentage of successful attempts, and the results are presented in Table 1.
We observe from the table that in all simulation experiments, the random sampling method is outperformed by our sampling-based heuristic method. Our method found the available configuration in less time (with less sampling times) with a much higher success rate compared to the random sampling method. It is worth noting that in sampling-based heuristic method, the reason why the sampled configuration is not available is that the configuration is in collision with the environment. On the contrary, in random sampling method, the reason is always that the configuration is in a self-collision status. It is because in our sampling-based heuristic method, the sampling is taken in a selected range and meanwhile the possible configuration is limited to a range so self-collision rarely occurs. Comparing the results of scenarios 1 and 2 with those of scenarios 3 and 4, when the allowed number of sampling times is changed from 30 to 10, the rate of success of the random sampling method significantly decreases to almost zero while the rate of success of sampling-based heuristic method does not change. It means that the average number of sampling times needed to find the collision-free configuration in the sampling-based heuristic method is much lower than that of the other method, and we can set a lower allowed number of sampling times to save time by avoiding unnecessary sampling attempts in trying to find an available configuration. It can be seen that sampling in the selected range with a template can not only save sampling time with a higher rate of success but also can improve the quality of the generated configuration for that it avoids self-collision situations and self-collision is not needed in the algorithm.
Then, in the same simulation environment shown in Figure 7, we conducted a preliminary experiment to validate the performance of our method in traversing the door-type scenes. Here, the path of the mobile base was given as a straight line while the reconfiguration of the manipulator was tested. As shown in Figure 7, four different obstacles were designed so that the mobile manipulator could pass through them only with a specific collision-free configuration. The mobile manipulator had to pass four obstacles in a row to complete the experiment. As shown in Figure 7 column c, when the mobile manipulator detected an obstacle, it would find the most similar template very quickly and find a suitable configuration for the manipulator which would not collide with the narrow channel. The results are shown in Table 2. The experiment was repeated 10 times and in all experiments the robot was able to change its configuration for each obstacle and reach the goal. The average time of planning for one obstacle is 1.2 s and the average execution time of each experiment is 20.5 s. In this experiment, the linear speed limit of our mobile manipulator was set to 0.5 m/s. Compared to the execution time, the time for path planning is much shorter.
Next, we could compare our method with a similar planner HAMP [24] and full 9D PRM in a similar scenario in the HAMP experiment [24] where the mobile manipulator was required to navigate from one side of the door to the other side through which the mobile manipulator has to change its configuration. In our experiment, the normal door was changed to a more complex shape as shown in Figure 7(1b). The results are shown in Table 3. In such a scenario, the average time HAMP needed to generate a global plan is 5.7 s, the average time PRM needed is 12.5 s [24], and our method needs 1.1 s on average for all planning including global planning for the mobile base and reconfiguration for the manipulator. With the linear speed limit of our mobile manipulator set to 0.5 m/s, the total execution time of the experiment is 7.3 s, which is just a little longer than the planning time of HAMP and even much shorter than the planned time of full PRM. The scenario in our experiment is more complex but has a more effective performance. However, there are some significant differences between our method and HAMP/full PRM, in HAMP/full PRM, the 3D map of the environment is given, while in our method only the 2D map is given, besides, HAMP/full PRM constructs the global path for both the mobile base and the manipulator at one time before the robot starts moving, while our method constructs the path incrementally as the robot moves. Thus, the comparison here is not so strict due to the differences, but to some extent, it can illustrate the efficiency of our method.
Finally, we conducted an experiment to validate the effectiveness of overall hierarchical motion planning we proposed for mobile manipulators.
The simulation scene is shown in Figure 8a. In the simulation environment, we constructed a large room with various obstacles. Before the experiments, we controlled the robot to move around the whole environment and constructed a 2D map. The constructed 2D map is shown in Figure 8b. The start configuration and target configuration of the mobile manipulator are also shown in the figure. The configuration of the start position for the mobile manipulator is (1, 1, 0, 0, 0, 0, 0, 0, 0), and the configuration of the target position is (11, 11, 1.57, 0, 0, 0, 0, 0, 0). The first three parameters are the configuration representations of the mobile base, i.e., the coordinates in the plane and the direction of the mobile base. The last seven parameters are the configuration representations of the manipulator, i.e., the joint angles of the manipulator. The goal of the experiment is to move the mobile manipulator from start to goal configuration without collision with the environment. We added some obstacles in the environment to test whether the motion planning method can deal with the change in the environment.
The mobile manipulator moved along the path in the start period as if there were no obstacle on the path. The local planner sent control signals to drive the mobile base to precisely follow the path, as shown in the first row of Figure 9. The on-board depth camera and planar lidar collect information about the environment. Collision checking is performed continuously. When the mobile manipulator moved near the round stool, which does not exist in the initial global map, the robot found that there was no way to avoid the obstacle, so a new global path was generated and the robot started to move along the new path, as shown in the second row of Figure 9. Later, the robot moved near a desk which is also not in the initial map, but this time the desk does not block the way of the mobile base, but a possible collision between the manipulator and the desk was detected, the robot had to find a new configuration for the manipulator, according to the shape of the obstacle, a new configuration for the manipulator was found and a path for reconfiguration was generated, then the manipulator changed it configuration and passed the obstacle as shown in the third row of Figure 9. After two obstacles, a new situation occurred, someone had placed a plank between a stool and a desk, leaving only a very narrow space for the robot. Although the mobile base could pass through freely, the manipulator had to find a collision-free configuration. In this situation, a new safe configuration for the manipulator was found, which allowed the whole robot to move through the narrow space, as shown in the fourth row of Figure 9. After these obstacles, the robot finally reached the target configuration, the total time used is 57.8 s on average.
From the result of the experiment, it can be seen that our hierarchical motion planning method can deal with the change in the environment of its nature of incremental motion planning. Our motion planning method with sampling-based heuristic configuration generating takes less time with a higher success rate than the conservative random sampling method. Compared with those traditional planning algorithms that are purely on the 2D plane, our method could deal with 3D obstacles that could collide with the manipulator. The results showed that it is effective in environments where conservative approaches will fail because the manipulator has to change its configuration several times while navigating from the start to the goal. Compared to those planning algorithms that plan in a global 3D map, our method does not require a 3D representation of the environment, so it avoids large memory requirements and does not need a long period of time to generate a global plan. Both the planning time and the execution time are decreased.

5. Conclusions and Future Work

This paper presents a method for mobile manipulator motion planning. The behavioral difference between the mobile base and the manipulator is taken into consideration. Both global planning and local planning are proposed for mobile manipulators. First, the global path for the mobile base is generated with an optimized A* algorithm, and the mobile base would move along the generated path. While the mobile base moves forward to the target configuration, the manipulator may collide with the environment, and the potential collision with the environment is checked. The fast collision checking is performed on a 2D plane perpendicular to the ground and directly in front of the robot. A sampling-based heuristic method is used to find a safe configuration quickly and efficiently for the manipulator. The manipulator would change its configuration several times to avoid collisions with obstacles. Several experiments were conducted in simulation environments. The results show that our planning method can deal with motion planning for mobile manipulators in a 3D environment and have reasonable performance.
However, our method has some limitations in that it struggles to deal with dynamic and cluttered environments where a collision-free path can hardly be found, and the possible constraints introduced by the manipulation task are not considered in the method. There are several aspects of our method that could be improved in future work. First, with the development of robotic object perception [30,31,32], the mobile manipulator could build a small-scale representation of the environment around itself with more object information, which would be very helpful to deal with complex 3D environments and have better manipulation capabilities. In addition, the manipulation task introduces many constraints to the motion planning, therefore, the whole-body motion planning method including redundancy resolution [33] and base position optimizition [34] has the potential to be added to our proposed method to plan a path satisfying various constraints introduced by the environment and the manipulation task. Furthermore, the real-time whole-body planning method is another issue that deserves further attention.

Author Contributions

Conceptualization, H.C. and X.Z. (Xizhe Zang); methodology, H.C.; software, H.C.; validation, H.C. and X.Z. (Xuehe Zhang); formal analysis, X.Z. (Xizhe Zang) and Y.L.; investigation, J.Z.; resources, H.C.; data curation, H.C.; writing—original draft preparation, H.C.; writing—review and editing, H.C. and X.Z. (Xizhe Zang); visualization, H.C.; supervision, X.Z. (Xizhe Zang) and Y.L.; project administration, X.Z. (Xizhe Zang) and X.Z. (Xuehe Zhang). All authors have read and agreed to the published version of the manuscript.

Funding

This research was in part funded by the National Key Research and Development Program, grant number 2022YFB4700802, and in part by the National Natural Science Foundation of China, grant number 92048301.

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Data Availability Statement

Not applicable.

Conflicts of Interest

The authors declare no conflict of interest.

References

  1. Khatib, O. Mobile manipulation: The robotic assistant. Robot. Auton. Syst. 1999, 26, 175–183. [Google Scholar] [CrossRef]
  2. Mason, M.T.; Pai, D.K.; Rus, D.; Taylor, L.R.; Erdmann, M.A. A Mobile Manipulator. In Proceedings of the 1999 IEEE International Conference on Robotics and Automation (ICRA), Detroit, MI, USA, 10–15 May 1999; pp. 2322–2327. [Google Scholar]
  3. Nassal, U.M. An approach to motion planning for mobile manipulation. In Proceedings of the 1994 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Munich, Germany, 12–16 September 1994; IEEE: Piscataway, NJ, USA, 1994; Volume 2, pp. 831–838. [Google Scholar]
  4. Janiak, M.; Tchoń, K. Towards constrained motion planning of mobile manipulators. In Proceedings of the 2010 IEEE International Conference on Robotics and Automation, Anchorage, AK, USA, 3–7 May 2010; IEEE: Piscataway, NJ, USA, 2010; pp. 4990–4995. [Google Scholar]
  5. Yang, Y.; Brock, O. Elastic roadmaps—Motion generation for autonomous mobile manipulation. Auton. Robot. 2010, 28, 113–130. [Google Scholar] [CrossRef]
  6. Sánchez-Ibáñez, J.R.; Pérez-Del-Pulgar, C.J.; García-Cerezo, A. Path Planning for Autonomous Mobile Robots: A Review. Sensors 2021, 21, 7898. [Google Scholar] [CrossRef] [PubMed]
  7. Gul, F.; Mir, I.; Abualigah, L.; Sumari, P.; Forestiero, A. A Consolidated Review of Path Planning and Optimization Techniques: Technical Perspectives and Future Directions. Electronics 2021, 10, 2250. [Google Scholar] [CrossRef]
  8. Castaman, N.; Pagello, E.; Menegatti, E.; Pretto, A. Receding Horizon Task and Motion Planning in Changing Environments. Robot. Auton. Syst. 2021, 145, 103863. [Google Scholar] [CrossRef]
  9. Saoji, S.; Rosell, J. Flexibly configuring task and motion planning problems for mobile manipulators. In Proceedings of the 2020 25th IEEE International Conference on Emerging Technologies and Factory Automation (ETFA), Vienna, Austria, 8–11 September 2020; IEEE: Piscataway, NJ, USA, 2020; pp. 1285–1288. [Google Scholar]
  10. Rastegarpanah, A.; Gonzalez, H.C.; Stolkin, R. Semi-Autonomous Behaviour Tree-Based Framework for Sorting Electric Vehicle Batteries Components. Robotics 2021, 10, 82. [Google Scholar] [CrossRef]
  11. Berenson, D.; Kuffner, J.; Choset, H. An optimization approach to planning for mobile manipulation. In Proceedings of the 2008 IEEE International Conference on Robotics and Automation, Pasadena, CA, USA, 19–23 May 2008; IEEE: Piscataway, NJ, USA, 2008; pp. 1187–1192. [Google Scholar]
  12. Kalakrishnan, M.; Chitta, S.; Theodorou, E.; Pastor, P.; Schaal, S. STOMP: Stochastic trajectory optimization for motion planning. In Proceedings of the 2011 IEEE International Conference on Robotics and Automation, Shanghai, China, 9–13 May 2011; pp. 4569–4574. [Google Scholar]
  13. Zucker, M.; Ratliff, N.; Dragan, A.D.; Pivtoraiko, M.; Klingensmith, M.; Dellin, C.M.; Bagnell, J.A.; Srinivasa, S.S. CHOMP: Covariant Hamiltonian optimization for motion planning. Int. J. Robot. Res. 2013, 32, 1164–1193. [Google Scholar] [CrossRef] [Green Version]
  14. Lavalle, S. Rapidly-Exploring Random Trees: A New Tool for Path Planning. Research Report 1999. Available online: http://msl.cs.illinois.edu/~lavalle/papers/Lav98c.pdf (accessed on 31 May 2023).
  15. Kavraki, L.; Svestka, P.; Latombe, J.-C.; Overmars, M. Probabilistic roadmaps for path planning in high-dimensional configuration spaces. IEEE Trans. Robot. Autom. 1996, 12, 566–580. [Google Scholar] [CrossRef] [Green Version]
  16. Kuffner, J.J.; LaValle, S.M. RRT-connect: An efficient approach to single-query path planning. In Proceedings of the 2000 IEEE International Conference on Robotics and Automation (ICRA), San Francisco, CA, USA, 24–28 April 2000; IEEE: Piscataway, NJ, USA, 2000; Volume 2, pp. 995–1001. [Google Scholar]
  17. Karaman, S.; Frazzoli, E. Sampling-based algorithms for optimal motion planning. Int. J. Robot. Res. 2011, 30, 846–894. [Google Scholar] [CrossRef] [Green Version]
  18. Denavit, J.; Hartenberg, R.S. A Kinematic Notation for Lower-Pair Mechanisms Based on Matrices. J. Appl. Mech. 2021, 22, 215–221. [Google Scholar] [CrossRef]
  19. Gammell, J.D.; Srinivasa, S.S.; Barfoot, T.D. Informed RRT*: Optimal sampling-based path planning focused via direct sampling of an admissible ellipsoidal heuristic. In Proceedings of the 2014 IEEE/RSJ International Conference on Intelligent Robots and Systems, Chicago, IL, USA, 14–18 September 2014; pp. 2997–3004. [Google Scholar] [CrossRef] [Green Version]
  20. Ward, J.; Katupitiya, J. Mobile Manipulator Motion Planning Towards Multiple Goal Configurations. In Proceedings of the 2006 IEEE/RSJ International Conference on Intelligent Robots and Systems, Beijing, China, 9–15 October 2006; IEEE: Beijing, China, 2006; pp. 2283–2288. [Google Scholar]
  21. Seyboldt, R.; Frese, C.; Zube, A. Sampling-based Path Planning to Cartesian Goal Positions for a Mobile Manipulator Exploiting Kinematic Redundancy. In Proceedings of the ISR 2016: 47st International Symposium on Robotics, Munich, Germany, 21–22 June 2016; VDE Verlag: Berlin, Germany, 2016; pp. 1–9. [Google Scholar]
  22. Brock, O.; Kavraki, L.E. Decomposition-based motion planning: A framework for real-time motion planning in high-dimensional configuration spaces. In Proceedings of the 2001 IEEE International Conference on Robotics and Automation (ICRA), Seoul, Republic of Korea, 21–26 May 2001; IEEE: Piscataway, NJ, USA, 2001; Volume 2, pp. 1469–1474. [Google Scholar]
  23. Gochev, K.; Cohen, B.; Butzke, J.; Safonova, A.; Likhachev, M. Path Planning with Adaptive Dimensionality. In Proceedings of the Fourth Annual Symposium on Combinatorial Search (SoCS-2011), Barcelona, Spain, 15–16 July 2011. [Google Scholar]
  24. Pilania, V.; Gupta, K. A hierarchical and adaptive mobile manipulator planner. In Proceedings of the 2014 IEEE-RAS International Conference on Humanoid Robots, Madrid, Spain, 18–20 November 2014; pp. 45–51. [Google Scholar]
  25. Li, Q.; Mu, Y.; You, Y.; Zhang, Z.; Feng, C. A Hierarchical Motion Planning for Mobile Manipulator. IEEJ Trans. Electr. Electron. Eng. 2020, 15, 1390–1399. [Google Scholar] [CrossRef]
  26. Barton, M.J. Controller Development and Implementation for Path Planning and Following in an Autonomous Urban Vehicle. Bachelor’s Thesis, The University of Sydney, Sydney, Australia, 2001. [Google Scholar]
  27. Grisetti, G.; Stachniss, C.; Burgard, W. Improved Techniques for Grid Mapping with Rao-Blackwellized Particle Filters. IEEE Trans. Robot. 2007, 23, 34–46. [Google Scholar] [CrossRef] [Green Version]
  28. Hart, P.E.; Nilsson, N.J.; Raphael, B. A Formal Basis for the Heuristic Determination of Minimum Cost Paths. IEEE Trans. Syst. Sci. Cybern. 1968, 4, 100–107. [Google Scholar] [CrossRef]
  29. Quigley, M.; Gerkeyy, B.; Conleyy, K.; Fausty, J.; Footey, T.; Leibsz, J.; Bergery, E.; Wheelery, R.; Ng, A. ROS: An open-source Robot Operating System. In Proceedings of the ICRA Workshop on Open-Source Software, Kobe, Japan, 17 May 2009; pp. 1–9. [Google Scholar]
  30. Xiong, P.; Liao, J.; Zhou, M.; Song, A.; Liu, P.X. Deeply Supervised Subspace Learning for Cross-Modal Material Perception of Known and Unknown Objects. IEEE Trans. Ind. Inform. 2023, 19, 2259–2268. [Google Scholar] [CrossRef]
  31. Xiong, P.; He, K.; Song, A.; Liu, P.X. Robotic haptic adjective perception based on coupled sparse coding. Sci. China Inf. Sci. 2023, 66, 129201. [Google Scholar] [CrossRef]
  32. Xiong, P.; Tong, X.; Liu, P.X.; Song, A.; Li, Z. Robotic Object Perception Based on Multispectral Few-Shot Coupled Learning. In IEEE Transactions on Systems, Man, and Cybernetics: Systems; IEEE: Piscataway, NJ, USA, 2023; pp. 1–3. [Google Scholar] [CrossRef]
  33. Fiore, M.D.; Meli, G.; Ziese, A.; Siciliano, B.; Natale, C. A General Framework for Hierarchical Redundancy Resolution under Arbitrary Constraints. IEEE Trans. Robot. 2023, 39, 2468–2487. [Google Scholar] [CrossRef]
  34. Xie, D.-J.; Zeng, L.-D.; Xu, Z.; Guo, S.; Cui, G.-H.; Song, T. Base position planning of mobile manipulators for assembly tasks in construction environments. Adv. Manuf. 2023, 11, 93–110. [Google Scholar] [CrossRef]
Figure 1. Hierarchical motion planning for mobile manipulator.
Figure 1. Hierarchical motion planning for mobile manipulator.
Sensors 23 06952 g001
Figure 2. Global path comparison. (a) Path planned by A* algorithm; (b) Optimized path planned by optimized A* algorithm.
Figure 2. Global path comparison. (a) Path planned by A* algorithm; (b) Optimized path planned by optimized A* algorithm.
Sensors 23 06952 g002
Figure 3. Point clouds and bounding balls for collision checking.
Figure 3. Point clouds and bounding balls for collision checking.
Sensors 23 06952 g003
Figure 4. The templates for collision-free configuration. (a) normal configuration for the manipulator; (bf) template configurations for the manipulator to avoid collision with different types of obstacles.
Figure 4. The templates for collision-free configuration. (a) normal configuration for the manipulator; (bf) template configurations for the manipulator to avoid collision with different types of obstacles.
Sensors 23 06952 g004
Figure 5. Template matching.
Figure 5. Template matching.
Sensors 23 06952 g005
Figure 6. Sampling range and generated configuration. (a,c,e) template configurations for the manipulator; (b,d) generated configurations with sampling around template configuration (c).
Figure 6. Sampling range and generated configuration. (a,c,e) template configurations for the manipulator; (b,d) generated configurations with sampling around template configuration (c).
Sensors 23 06952 g006
Figure 7. Simulation experiment for sampling-based heuristic method. (1a,2a,3a,4a) show the point clouds used in collision checking for scenario 1–4; (1b,2b,3b,4b) show the simulation environments of scenario 1–4; (1c,2c,3c,4c) show the suitable configurations for the manipulator which would not collide with the environment for scenario 1–4.
Figure 7. Simulation experiment for sampling-based heuristic method. (1a,2a,3a,4a) show the point clouds used in collision checking for scenario 1–4; (1b,2b,3b,4b) show the simulation environments of scenario 1–4; (1c,2c,3c,4c) show the suitable configurations for the manipulator which would not collide with the environment for scenario 1–4.
Sensors 23 06952 g007aSensors 23 06952 g007b
Figure 8. The simulation environment scene.
Figure 8. The simulation environment scene.
Sensors 23 06952 g008
Figure 9. Simulation Experiment. (1a,2a,3a,4a,5a) show the configurations for the mobile manipulator in the experiment; (1b,2b,3b,4b,5b) show the global map for the mobile base in the experiment and the red line in each map is the global path; (1c,2c,3c,4c,5c) show snapshots for the mobile manipulator in the experiment. Please see the text for a description.
Figure 9. Simulation Experiment. (1a,2a,3a,4a,5a) show the configurations for the mobile manipulator in the experiment; (1b,2b,3b,4b,5b) show the global map for the mobile base in the experiment and the red line in each map is the global path; (1c,2c,3c,4c,5c) show snapshots for the mobile manipulator in the experiment. Please see the text for a description.
Sensors 23 06952 g009
Table 1. Experimental results in 4 scenarios for reconfiguration.
Table 1. Experimental results in 4 scenarios for reconfiguration.
Scenario
ID
MethodPermitted # of Sampling Times# of Self-Collision
Times Mean
# of Collision with Environment Times Mean# of Sampling
Times Mean
Sampling Time(s)
Mean
#Succ.
/#Runs
1Our method
Random Sampling
3006.47.30.628/30
22.327.527.72.67/30
2Our method
Random Sampling
3002.13.10.330/30
20.526.126.32.75/30
3Our method
Random Sampling
1001.72.70.229/30
7.39.89.80.91/30
4Our method
Random Sampling
1001.32.30.230/30
7.710100.90/30
Table 2. Experimental results in passing four doors in a row.
Table 2. Experimental results in passing four doors in a row.
MethodPlan Time(s) MeanRun Time(s)#Succ./#Runs
HMP1.220.510/10
Table 3. Experimental results in passing a low door (hmp vs. Hamp vs. Full prm).
Table 3. Experimental results in passing a low door (hmp vs. Hamp vs. Full prm).
MethodPlan Time(s)Run Time(s)
HMP1.17.3
HAMP5.7N/A
Full PRM12.5N/A
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

Chen, H.; Zang, X.; Liu, Y.; Zhang, X.; Zhao, J. A Hierarchical Motion Planning Method for Mobile Manipulator. Sensors 2023, 23, 6952. https://doi.org/10.3390/s23156952

AMA Style

Chen H, Zang X, Liu Y, Zhang X, Zhao J. A Hierarchical Motion Planning Method for Mobile Manipulator. Sensors. 2023; 23(15):6952. https://doi.org/10.3390/s23156952

Chicago/Turabian Style

Chen, Hanlin, Xizhe Zang, Yubin Liu, Xuehe Zhang, and Jie Zhao. 2023. "A Hierarchical Motion Planning Method for Mobile Manipulator" Sensors 23, no. 15: 6952. https://doi.org/10.3390/s23156952

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