Next Article in Journal
Data Reduction in the String Space for Efficient kNN Classification Through Space Partitioning
Next Article in Special Issue
Optimization of Motion Planning and Control for Automatic Machines, Robots and Multibody Systems
Previous Article in Journal
Improved Solar Operation Control for a Solar Cooling System of an IT Center
Previous Article in Special Issue
Energy Optimization of Functionally Redundant Robots through Motion Design
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Real-Time Hybrid Navigation System-Based Path Planning and Obstacle Avoidance for Mobile Robots

Department of Mechatronics, HCMC University of Technology and Education, Ho Chi Minh 700000, Vietnam
*
Author to whom correspondence should be addressed.
Appl. Sci. 2020, 10(10), 3355; https://doi.org/10.3390/app10103355
Submission received: 14 March 2020 / Revised: 13 April 2020 / Accepted: 7 May 2020 / Published: 12 May 2020

Abstract

:
In this work, we present a complete hybrid navigation system for a two-wheel differential drive mobile robot that includes static-environment- global-path planning and dynamic environment obstacle-avoidance tasks. By the given map, we propose a multi-agent A-heuristic algorithm for finding the optimal obstacle-free path. The result is less time-consuming and involves fewer changes in path length when dealing with multiple agents than the ordinary A-heuristic algorithm. The obtained path was smoothed based on curvature-continuous piecewise cubic Bézier curve (C2 PCBC) before being used as a trajectory by the robot. In the second task of the robot, we supposed any unforeseen obstacles were recognized and their moving frames were estimated by the sensors when the robot tracked on the trajectory. In order to adapt to the dynamic environment with the presence of constant velocity obstacles, a weighted-sum model (WSM) was employed. The 2D LiDAR data, the robot’s frame and the detected moving obstacle’s frame were collected and fed to the WSM during the movement of the robot. Through this information, the WSM chose a temporary target and a C2 PCBC-based subtrajectory was generated that led the robot to avoid the presented obstacle. Experimentally, the proposed model responded well in existing feasible solution cases with fine-tuned model parameters. We further provide the re-path algorithm that helped the robot track on the initial trajectory. The experimental results show the real-time performance of the system applied in our robot.

1. Introduction

1.1. Motivation

Jobs in the service sector are gradually being occupied by robots because of their superior capabilities over humans, such as tireless work, low cost, robust and high precision. In order for robots to be flexible and meet work needs, service robots are often equipped with a movable platform. Due to many objective factors in the robot workspace, such as obstacle-rich workspace, environments with human presence, their mobility in indoor or outdoor workspaces is greatly limited without a matching navigation system. Navigation systems instruct a robot to go to a desired location safely, as they are capable of helping the robot respond to changes in the operating environment during travel. With the requirements of increasingly capable robots, navigation systems must also be complete and more accurate. Therefore, many navigation schemes have been rapidly developed depending on a particular environment and the structure of the robot. Currently, navigation systems for robots that operate indoors can navigate the robot move to a target with a given map. However, robots do not even have the ability to react to dynamic environments or in the presence of humans. Developing an autonomous robot that works in dynamic environments requires navigation systems that are able to collect information from the environment surrounding the robot, simultaneously process the given map and continuously re-plan motion for the robot in order to safely reach the target. Most currently used navigation systems for service robots can be roughly categorized into two main types: global path planning and obstacle avoidance, which are introduced in detail in this study [1]. With a given map, path planning traces a trajectory from the robot to the desired position that meets the safety and kinematic constraints of the robot. In addition, the path-planning method needs to be optimized to some criteria. However, in the presence of unforeseen obstacles, the robot may not be able to reach the desired target. On the other hand, obstacle-avoidance methods help a robot identify obstacles by using sensor information and updates the direction of movement to avoid obstacles and safely reach the target. In complex environments with many obstacles, an obstacle-avoidance method will be ineffective if the target is far away from the robot. This study proposes a navigation solution for a service robot that works in our laboratory. The robot has a two-wheel differential drive platform for movement, light detection and ranging sensor (LiDAR) mounted in the platform for vision.

1.2. Related Work

1.2.1. Global Path Planning Approach

Many global path-planning methods have been studied, each with its own criteria for optimization that depend on the particular environment. It is possible to divide path planning into two categories by decision-making based classification: deterministic (A-heuristic, D algorithm, etc.) and non-deterministic (particle swarm optimization, rapidly exploring, random tree, ant colony optimization, etc.). The artificial potential field [2] is a deterministic algorithm that simulates a magnetic field with a target acting as an attractive field and obstacles acting as the repulsive field. The robot acts as a particle under the effect of these fields. The advance of [2] is to find a suitable path without stacking caused by the local minima of its optimization problem (cul-de-sac case) and reducing the oscillation of the path (zigzag). A remarkable point is the regression search method that looks for nonadjacent points as long as the line between them does not exist an obstacle and remove the remaining points. Based on that, an optimized-length path can be obtained which original APF cannot produce directly. The genetic algorithm is presented in [3] that can be considered as a search heuristic that is inspired by Charles Darwin’s theory. The algorithm presented in [3] could not find the shortest path since it uses the Manhattan distance instead of Euclidean distance for fitness value. A major drawback of the genetic algorithm is that it is computationally expensive for finding an optimal path. PSO of Ferguson splines were applied in [4] for path planning. Using the algorithm, the robot can find a trajectory directly. However, with a complex map, finding a solution for the problem requires many particles (particles are used to construct spline segment), i.e., the calculation becomes very difficult without prior sub-targets. The A-heuristic algorithm was introduced in [5,6] that was used to solve the global path-planning task with the given map. The highlight in [5] is the consideration of unsafe diagonal movements, sharp turns and robot size that the original algorithm does not consider. Turning score was added to the weight of each cell in [6] to improve the optimal motion of the robot. Wu, et al., present the interesting control system for the global path planning that can adapt to the presence of the static unforeseen obstacles in [7]. Their algorithm is based on the VFH* that directly produces the smooth trajectory. However, in many cases, these trajectories just can be applicable for omnidirectional mobile robots. In [8], Kazem, et al., modified the VFH method and applied neuron network learning model in order to enhance ability to react with critical situations of robot.
A-heuristic algorithm is the simple, time-efficient algorithm and its performance is acceptable. Furthermore, special features of this algorithm are easily modified and its result is always existing for the reachable target. However, in mobile-robot path planning, we need to consider the size and kinematics constraint of the robots in order to generate the trajectory for it. We will consider these problems in Section 3.

1.2.2. Moving Obstacle-avoidance Approach

Analysis of the time–space relative trajectory of the robot and obstacle is employed in [9]. The result was obtained by finding the intersection between reachable cone and avoiding line that clearly demonstrated in [9]. However, the shape of the reachable cone depends on the robot’s linear speed during the robot’s movement on a local path. In order to obtain the optimal solution between many criteria, Yamada, et al., used like-WSM which takes the distance between the robot and obstacle, time to reach to the minimum distance between the robot and obstacle, reachable maximum linear speed and offset angle between the robot heading and the robot via point direction into account. Ferrara, et al., proposed mobile robot navigation in dynamic environments by using time-varying harmonics APF in [10]. A fuzzy controller used to follow the given path and avoid obstacles was introduced in [11]. Fuzzy is a common approach of many control tasks of robots since it is flexible and has the capability to handle problems with imprecise and incomplete data. Mitrovic, et al., attempted to indicate the evading static obstacle ability. With the proposed approach in [12], the robot also can avoid moving obstacles in some cases: overtaking, directly passing, but cannot have a good performance in the arbitrary situation. A few recent works have come up with novel methods such as no-target obstacle-avoidance for mobile robot [13]. Kong, Haiyi, et al., introduced the No-Target Bug1 and No-Target Bug2 algorithms for online-path planning. Since these algorithms are based on APF, they hardly adapt to the dynamic environment where the moving obstacles are presented.
In our case, we proposed an analysis time–space relative trajectory method for determining collision and weighted-sum model for obtaining optimal local path since it is simple, fast and results are acceptable.

1.3. Contributions

This work has two main contributions. First, by presenting a multi-agent A-heuristic algorithm and piecewise cubic Bézier curve, the robot trajectory was planned. A re-path algorithm was deployed to help the robot track on the planned trajectory. It greatly reduced the processing time of the robot and maximized its speed. The second contribution is the capacity of the robot that can avoid moving obstacles by using a weighted-sum model and context analysis method. In a not-too-complicated case, this model could optimize the length of the robot trajectory very quickly, and the collision rate was quite low.

2. Review of Hybrid Navigation Systems

The main objective of this study was to provide a system in order to manipulate autonomous robots that move from initial pose PR(0), ψR(0) to the desired location and heading PD, ψD with a given map. In order to archive this, the robot must have a suitable navigation scheme. According to [14], the robot’s navigation scheme can be determined through four main tasks:
-
Collect the data about the robot’s workspace in the form of a map;
-
Plan a collision-free path from the original position of the robot to the desired position;
-
Generate trajectory for the robot that meets the velocity and acceleration limits of the robot;
-
Avoid unforeseen obstacles—be they static or dynamic—and keep tracking initial trajectory.
This study assumes that the robots can localize themselves and obstacles can be detected by the robot on the known map. This work only focuses on three main tasks: path planning, trajectory generation and obstacle-avoidance with the processed sensor data. We propose a hybrid navigation system as in Figure 1. The advantages of this kind of system is clearly demonstrated in the study [14] and have good reality performance in [15]; its constituents can be summarized as follows:
-
Deliberative layer uses prior-data in the form of map to trace a path from the position of the robot to the desired position. This type of path is called a global path. This layer is responsible for the path-planning task;
-
Reactive layer uses information extracted from sensors to evaluate and decide to create a path to help the robot respond to unforeseen obstacles. This type of path is called the local path. This layer undertakes the obstacle-avoidance task;
-
Executive layer decides which path to follow, while controlling the robot to follow the selected path.
In the Section 4, Section 5, Section 6 and Section 7, we propose methods to solve each task of the robot individually to complete the proposed navigation system seen in Figure 1. In Section 3, we briefly introduce the robot kinematic model. In Section 4, we introduce the A-heuristic algorithm for path-planning and propose our modification based on this algorithm. In Section 5, we apply the PCBC for smoothing the planned path. In Section 6, we introduce the problem in discrete control and explain our re-path algorithm for the trajectory tracking task. In Section 7, we focus on constructing the reactive layer of our navigation system that helps the robot to perceive and choose the appropriate path for avoiding moving obstacles.

3. Two-Wheel Differential Drive Platform Kinematics

This research is based on a simple 2-wheel differential drive mobile platform that has two independently controlled wheels and one omnidirectional wheel for balancing. The robot moves on the flat lane, localization by LiDAR and can be express by relation between reference frame {W} and the mobile robot’s own frame {R}. Robot frame {R} = (PR(t),ψR(t)) is defined by position vector of robot respect to reference frame and robot heading, respectively. Let (VR(t), ωR(t)) be the instantaneous linear speed and angular speed of robot body based on {W}, (θl(t),θr(t)) be the left and right wheel angular speed, r be the radius of the driving wheel, L be a distance between two wheels. Because each command of a CPU just can accelerate a circular motion only one wheel independently, the control equation based on robot motion has form like as.
[ θ ˙ r ( t ) θ ˙ l ( t ) ] = [ 1 r w l w 2 r w 1 r w l w 2 r w ] [ V R ( t ) ω R ( t ) ]
On the other hand, in this work, robot will continuously move along the smoothed path. The necessary condition in the path design procedure is a twice differentiable path. The given smoothed path featured by its curvature at each point on the curve. Let the curve C(t) is the desired path of the robot, we can archive the curvature by below equation.
κ ( t ) = x ˙ C ( t ) y ¨ C ( t ) x ¨ C ( t ) y ˙ C ( t ) ( x ˙ C 2 ( t ) + y ˙ C 2 ( t ) ) 3
Because the unit of curvature does not involve time and is supposed to be intrinsic to a curve C(t), it is independent of the speed of the robot. Let VS(t) and ωS(t) be the desired linear velocity and angular velocity of robot when moving along the desired path. According to Equation (2), we have:
κ ( t ) = ω S ( t ) V S ( t )

4. Path Planning

4.1. Modified A-Heuristic Algorithm (Path Finding)

A-star searching is the most popular grid-based path-planning algorithm because it is effective and low-cost for processing times. A-star is similar to Dijkstra’s algorithm, but it uses a heuristic approach that makes A-star searching faster than others without it. The A-heuristic algorithm searches an optimal path by giving a prior map, starting point and destination point. It adds the heuristics function to the weight of every candidate solution. By guesting the distance of every possible route to the target point, it can skip checking many undesirable solutions and make the algorithm faster. The weight of each point can be estimated by the equation below.
f n = g n + h n
where hn is the distance between a current checking point to the target point; gn is the length of the route between the initial point and the current checking point that contains the last checking point; fn is the total weight of the current checking point.
This research uses the A-star algorithm for path planning of mobile robot given the prior data. The data were taken before and converted to a binary map which can be expressed as the below matrix.
M i , j = { 1 ( i , j ) o b s S e t 0 o t h e r w i s e
A-star searches for the optimal path based on a grid-based map. However, we cannot search point-by-point because the memory of the processor will be exceeded and require a long processing time for a large map. For this reason, a grid is generated based on the robot’s position and size. Every spot in the grid contains many points; this is the sub-binary matrix of the entire map. Its size equal to twice the size of robot. For convenience, we consider each spot as the point of reduced-resolution map and be evaluated by the sum of all value of points in spot. The spot matrix (6) acts as the binary map with value 1 (spot contains partial obstacle) and value 0 (free collision spot).
S p o t x , y = { 1 ( i , j ) [ x s , x + s ] × [ y s , y + s ] M i , j > 0 0 o t h e r w i s e
If robot searches spot-by-spot on the map, the case that the next spot and the current spot lie on the diagonal line, the partial unobservable route appeared during the check (Figure 2).
To overcome this problem, one square searching window is defined by four spots; the robot is in the middle of this searching window instead of the spot (Figure 3a). By searching spot-by-spot, the search window can handle the partially unobservable route in the diagonal line for robot (Figure 3b). When the searching window comes to any spot, it will evaluate whether the spot does or does not contain a obstacle. If a spot contains an obstacle, the search window does not evaluate that anymore.
In this work, we also accelerate the searching speed of A-heuristic algorithm by using parallel handling. The A-star algorithm concurrently checks multiple windows (multi-agents) at the same time. These agents must meet the requirements:
-
Each agent’s current checking window does not have the same location with the other in the current checking set;
-
Current checking set has the lowest total f-score in open set;
-
Number of current checking windows does not exceeded the processing time.
Each current checking window takes into account 8 neighbor windows. The set of all neighbor windows may have redundant windows due to overlap. If any neighbor window overlaps with another in the neighbor set, the A-star will consider its g-score. The algorithm will select the neighbor window that has the lowest g-score in the overlapping window set to take account in the next step. Other steps in the multi-agent A-star algorithm are similar to the origin. However, these agents share the open and closed sets. By this method, the algorithm can be faster, and memory also does not accumulate exponentially which results in Figure 4.

4.2. Significant Points Extraction

P a t h S e t = { P ( 0 ) , P ( 1 ) , , P ( n 1 ) }
The above path point set is produced by A-heuristic algorithm (illustrated in Figure 5a) still needs to be reprocessed before the smoothing path algorithm plays its role. Since A-heuristic has a limit in searching direction and distance between consecutive checking points, it produces the oscillated path that makes robot difficultly continuously follows [16], i.e., directly smoothing this path point set for robot trajectory produce large curvature trajectory and make robot decelerates to follow trajectory or slipped out trajectory many times. One more significant reason is reducing memory costs when smoothing path because the greater number of path point set causes increasing memory using to produce a smooth trajectory. First, by removing points in the same line, we can greatly reduce the number of points in the path point set. The significant point set can be present as (8) and illustrated in Figure 5b corresponding to the current example.
s i g n i f i c a n t S e t = { P ( i ) | P ( i + 1 ) 2 P ( i ) + P ( i 1 ) 0 , P ( i ) p a t h S e t } { P ( 0 ) , P ( n 1 ) }
k = { 1 , 2 , , n 2 }
Geometrically, the A-heuristic algorithm produces redundant triangular paths caused by its limit in the searching direction. The shortening triangular path by the regression search method is employed. The robot sequentially checks the segmented line between the pairs of point {Pi,Pi+2} with the obstacle-scaled map Mi,j. If the line segment does not contain any obstacle the point Pi+1 will be removed, otherwise, the algorithm will continuously be checking {Pi+1,Pi+3}. This process will be repeated until no points are disqualified. The Figure 5c illustrates the significant point set in Figure 5b that is applied the regression search method.

5. Trajectory Generation by Piecewise Cubic Bézier Curve

5.1. Background

Named for Pierre Bézier, Bézier curves employ two endpoints called anchor points which defines the span of the line segment, which at least one additional point called control points—points used to give curviness to the original line segment. Bézier curve B is a parametric curve that can be expressed as the polynomial function (9) of degree n based on n+1 control point.
B ( u ) = i = 0 n ( n i ) ( 1 u ) n i u i P i
where, u [ 0 , 1 ] with P0, Pn is anchor points.
Directly using the original Bézier curve to smooth robot trajectory turns out many shortcomings. First, generating an n-order Bézier curve in order to smooth the path based on n+1 significant point cause difficultly to control curviness. Second, as the order of the equation increases, the complexity, and therefore the processing time increase. Third, Bézier curves always pass through anchor points and contained in convex hull constructed by the control point set. Therefore, the curve rarely passes through points in the significant point set. This property causes a great difference between the curve and initial path set produced by A-heuristic algorithm.
There are many ways to tackle this problem, divide and conquer is the basic approach. Robot trajectory is disjointed to many curve segments. The number of curve segments is based on the number of points of significant point set. By adding k control points to each curve segment, it becomes k+1 order Bézier curve that can be presented in Equation (10). Each curve segment passes through 2 anchor points which are points in significant point set. The new curve is the piecewise (k+1) order Bézier curve and passes through all points of significant point set. The second anchor point (endpoint) of the vth curve shares the first anchor point (start point) of the (v+1)th curve (Equations (11) and (12)). This reason makes any piecewise Bézier curve becomes the continuous function over its domain.
B ( u , v ) = ( 1 u ) k + 1 P A ( v ) + j = 1 k ( k + 1 1 ) ( 1 u ) k j + 1 u j C j ( i ) + u k + 1 P A ( v + 1 ) u [ 0 , 1 ] , v { 0 , 1 , , n 1 }
B ( 0 , v ) = P A ( v )
B ( 1 , v ) = B ( 0 , v + 1 )

5.2. C2 Continuous PCBC

To turn the Bézier curve path into a robot trajectory, the curve must meet robot kinematic constraints. Oscillated curves can make robots slip out of the desired trajectory. On the other hand, different from car-like robots, differential drive robot can track on C0 curve, but it is difficult to establish the controller for robot to track on it. The velocity and acceleration of robot must be continuous, thus, curve with continuous curvature meets 2 wheels differential drive mobile robot kinematic. Each curve segment is the distinct Bézier curve which has k+1 order polynomial function, i.e., each curve segment is Ck+1 function. The problem comes from the point that links 2 segments. The entire curve is undifferentiable at these points. Therefore, we must define Equations (13) and (14) to satisfy the kinematic constraint of robot.
B ˙ ( 1 , v ) = B ˙ ( 0 , v + 1 )
B ¨ ( 1 , v ) = B ¨ ( 0 , v + 1 )
Cubic Bézier curve is the suitable solution because it has a 3rd-order polynomial function and it is not-too-complicated. By setting each segment to be cubic Bézier curve, we have the matrix-form of entire PCBC that presented in (15).
B ( u , v ) = [ u 3 u 2 u 1 ] [ 1 3 3 1 3 6 3 0 3 3 0 0 1 0 0 0 ] [ B ( 0 , v ) C 1 ( v ) C 2 ( v ) B ( 1 , v ) ] u [ 0 , 1 ] , v { 0 , 1 , n 1 }
According to Equations (13) and (15) and (14) and (15), we have the Equations (16) and (17), respectively.
C 2 ( v ) = C 1 ( v + 1 )
C 1 ( v ) + 4 C 1 ( v + 1 ) + C 1 ( v + 2 ) = 4 P A ( v + 1 ) + 2 P A ( v + 2 )
Equations (16) and (17) can be expanded into the system with n-2 equations and n variables. To constrain the last 2 variables C1(0) and C2(n-2), Equations (18) and (19) are employed with ψA(0) and ψA(n-1) are the initial angle of robot and destination angle, respectively.
C 1 ( 0 ) = P A ( 0 ) + [ cos ( ψ A ( 0 ) ) sin ( ψ A ( 0 ) ) ] P A ( 1 ) P A ( 0 ) 3
C 1 ( n 1 ) = P A ( n 1 ) + [ cos ( ψ A ( n 1 ) ) sin ( ψ A ( n 1 ) ) ] P A ( n 1 ) P A ( n 2 ) 3
Experimentally, C1(0) and C1(n-1) determined by one-third of the Cartesian length between the corresponding point and the neighbor point in a significant point set. C1(n-1) is not used to construct the PCBC, but the insertion of it completes the system of Equations (16) and (17). The complete system of equation can be express as Equation (20).
[ 1 0 0 1 4 1 0 0 1 4 1 0 0 1 4 1 0 1 ] [ C 1 ( 0 ) C 1 ( 1 ) C 1 ( 2 ) C 1 ( n 2 ) C 1 ( n 1 ) ] = [ C 1 ( 0 ) 4 P A ( 1 ) + 2 P A ( 2 ) 4 P A ( 2 ) + 2 P A ( 3 ) 4 P A ( n 2 ) + 2 P A ( n 1 ) C 1 ( n 1 ) ]
By solving the system of Equation (20), all control points can be obtained. The PCBC now has continuous curvature over the entire curve and only depends on the set of anchor points, start angle and destination angle. The significant point set in Figure 5c that fed to Equation (20) results in the continuous curvature over the entire path illustrated in Figure 6.
The arc length of the υth segment given u = μ can be found by Equation (21).
l ( μ , υ ) = 0 μ B ˙ ( u , υ ) d u
The arc length of entire PCBC respect to curve parameters μ, υ can be obtain by sum up total arc length of ({v}0υ-1)th curve segments and arc length of the υth curve segment given u=μ that presented in Equation (22).
L ( μ , υ ) = v = 0 υ 1 l ( 1 , v ) + l ( μ , υ )

6. Discrete Time Control Method

PCBC is the curve that has a parameter that does not respect to arc length [17]. Therefore, it cannot be used directly as a robot trajectory. To solve this problem, reparameterization is required. This study employs a local linear approximation approach for approximating the curve parameter based on the arc length.
Based on Equations (21) and (22), by sampling curve parameter we can obtain Table 1 for converting between arc length and curve parameter.
Let LR(t) be the total distance traveled by the robot from its initial position to PR(t). Suppose that robot have followed the curve, from the table above, we can approximate the value of the curve parameter u and v respect to t.
u ( t ) = u ( L R ( t ) ) v ( t ) = v ( L R ( t ) )
Let PR(t) = PBR(t) = {u(t),i(t)} be the desired position of the robot on curve respect to curve parameter at time t. Let κ(t) = κ(u(t),i(t)) be curvature of curve at time t. According to Equation (2), κ(t) can be achieve by equation below.
κ ( t ) = B ˙ ( u ( t ) , v ( t ) ) × B ¨ ( u ( t ) , v ( t ) ) B ˙ ( u ( t ) , v ( t ) ) 3
Let VS(t), ωS(t) is the desired linear and angular speed of robot at time t; θ ˙ R S ( t ) , θ ˙ L S ( t ) are the desired right and left wheel angular speed of robot, θ ˙ max is the maximum angular speed that robot gear can achieve. According to Equations (1) and (3), if κ(t) > 0 then set θ ˙ R S ( t ) = θ ˙ max and θ ˙ L S ( t ) by the Equation (25).
θ ˙ L S ( t ) = 2 κ ( t ) l w 2 + κ ( t ) l w θ ˙ R S ( t )
If κ(t) < 0 then set θ ˙ L S ( t ) = θ ˙ max and θ ˙ R S ( t ) based on Equation (25). According to Equation (1) we can obtain VS(t) and ωS(t).
According to Equations (24) and (25), the robot can constrain its speed when moving on a trajectory. However, as the discussion in [18], maintaining maximum speed on one gear causes the robot to easily slip out of the desired trajectory when the robot goes through a trajectory segment which has large curvature due to its failure to respond to the acceleration in the other gear. That reason causes deviations between VS(t), ωS(t) and VR(t), ωR(t). Together with the open system, the robot cannot determine the error between its actual position and desired position on the curve that causes cumulative errors described in Figure 7. Therefore, the desired position of the robot on the curve will be different from the actual position P R ( t ) P R ( t ) . To be able to create a closed-loop system, the robot will refer to its true position by localization sensors, while the desired position on the trajectory is determined by the parameter of the curve determined by Equation (15) and (23). By the position error, the robot needs to be navigated for returning initial trajectory. To overcome this problem, we propose a method of re-path algorithm summarized in Figure 8. Instead of changing the robot behavior, our method changes shape of initial trajectory. Let ε(t) be the position error of the robot. If |ε(t)| > εmax then based on the main trajectory, the robot will reproduce a new path that does not differ from the remaining path to help the robot return desired position. The new path receives the actual current position of the robot is the initial point, Pback(t) is the point located in the curve and it is added to the new path. points in path point set that the robot has not passed through are also added to the new path. The C2 PCBC generator takes its role and generates a new trajectory called a reshaped trajectory. The curve parameters which localize Pback(t) can be achieved by Equation (26).
u b a c k ( t ) = u ( L R ( t ) + Δ L b a c k ) v b a c k ( t ) = v ( L R ( t ) + Δ L b a c k )
If iback(t) and uback(t) do not exceed maximum parameters of PCBC, P b a c k ( t ) can be obtained by equation below:
P b a c k ( t ) = B ( u b a c k ( t ) , v b a c k ( t ) )
Otherwise:
P b a c k ( t ) = P ( n 1 )
where P ( n 1 ) is the given target position of the robot. Figure 9 illustrates the case in that the robot slip out of trajectory and attempting to get back the initial trajectory by employing the re-path algorithm.

7. Obstacle-Avoidance

7.1. Detect Collision by Using Gradient Descent and Context Analysis Based Obstacle-Avoidance Scheme

For convenience, we assume that the robot sensors have already detected moving obstacles when it moves over the scanning area. The information from sensors can obtain which includes a radius of the circular boundary of obstacle body, position of center of boundary and constant linear velocity. It has two distinct cases when the robot detects the object:
-
Obstacle passes over the dead zone.
-
Obstacle passes over the scanning zone, but not dead zone. These zones of sensors were introduced in Figure 10.
Each case has different behaviors to avoid the obstacle based on context analysis and is illustrated in Figure 11. In the first case, when an obstacle suddenly passes over the dead zone (unpredictable case), the robot will try to stop and turn to the left until the obstacle does not present in the dead zone anymore. In the second case, when an obstacle passes over the scanning zone, the robot will check whether a collision is occurring. If the current trajectory were free-obstacle, the robot would continue to track on it. Otherwise, the robot must change the velocity and plans a new path. In this work, we assume the robot is on the emergency situation and needs to move as fast as possible. Therefore, in the second case, to an avoid obstacle, the robot must change the velocity direction instead of slowing down. The robot will generate a new path that will help the robot dodge the moving object and lead the robot back to the initial path at some point further. The new path has optimized arc length. Let { O } = ( P O ( t ) , ψ O ) be the obstacle frame respect to reference frame, obstacle moving with constant velocity V O and R O be a radius of the circular boundary. If the distance between obstacle and the robot is equal or less than sum of radius of them then collision between the obstacle and the robot will occur. Let P O R ( t ) is the relative position of object respect to the robot position determined by Equation (29).
P O R ( t ) = P O ( t ) P R ( t )
The path is safe if the minimum distance between the robot and moving obstacle is greater than sum of radius of them. This condition is held by the inequation below.
min t [ t 0 , ) P O R ( t ) > R R + R O
However, the derivative of Equation (29) is very complicated. Solution of inequation (30) can be obtained by using the univariate gradient descent algorithms with initial solution candidate t0 is assigned by the time when the robot detects obstacle and initial learning rate is γ0. By Equations (31) and (32), the robot can find out candidate solution very fast.
t n + 1 = t n γ n P O R ( t n )
γ n = t n t n 1 P O R ( t n ) P O R ( t n 1 )
According to the Equation (29) and established candidate solution of (31), the shortest distance between obstacle and the robot is obtained. By the condition (30), the robot can decide to continue following the initial path or getting a new path. If the robot detects the collision, the robot will construct a new path by following these steps:
-
Decide offset angle for a new direction to avoid the obstacle;
-
Repeat step 1 until the obstacle has not been observed anymore;
-
Interpolate back point which is inside the initial path in order to help the robot get back main trajectory;
-
Construct reshaped trajectory.
In step one, we propose the multi-objective optimization problem to decide offset angle.

7.2. Decide Offset Angle by Using WSM

Let αr, lr be angular measure range and long-range of sensor. Let α(t) ∈ [-αr/2, αr/2] be the desired offset angle of the robot at t when the robot detected the collision, The range of offset angle is based on angular measure range of sensor because the robot keeps moving at high speed that causes dangerous case when the robot turns to the unobservable direction. The offset angle is selected based on these below functions and conditions:
Function 1. l(α,t) is the distance that pulsed light wave emitted at α was traveled at time t subtracts dead zone radius. This distance is extracted from sensors data;
Function 2. d O R min ( α , t ) is the smallest distance from the robot to the estimated relative trajectory; between the object and the robot at an alpha angle and time t;
Function 3. d B R min ( α , t ) is the smallest distance from the new estimated robot position to the desired trajectory when the robot moves in the direction formed by α;
Function 4. tα(α,t) is the time it takes a robot to achieve compensation angle α at time t when the robot is moving with VR(t), ω(t);
Condition 1. If l(α,t) is maximized at α, α will be selected;
Condition 2. If d O R min ( α , t ) is maximized at α, α will be selected;
Condition 3. If d B R min ( α , t ) is minimized at α, α will be selected;
Condition 4. If tα(α,t) is minimized at α, α will be selected;
These conditions involve four objective functions (33) that must be optimized simultaneously.
max α l ( α , t ) max α d O R min ( α , t ) min α d B R min ( α , t ) min α t α ( α , t ) } s u b j e c t   t o   α [ α r 2 , α r 2 ]
A very common method to ranking candidate solutions against a set of n-objective functions is the weighted-sum method. WSM illustrated in Figure 12 turns original n-objective functions into a single objective function. This method’s features are described in detail in [19]. We call the needed maximizing function is a beneficial factor and needed minimizing function is a non-beneficial factor. Before WSM takes its role, all factors should be normalized. A beneficial factor will be divided by its optimal value. Inverse of a non-beneficial factor will be multiplied by its optimal value. Let w1, w2, w3, w4 are weight values of WSM, respectively that meet condition w1 + w2 + w3 + w4 = 1. By WSM we obtain the total weighted factor f(α,t).
The selected α that optimal the total weighted factor. By this value, the new subtrajectory is generated.
Let Rα be the radius of circle those centers located at current position of the robot, Pα(t) be any point on the circle can be determined via:
P α ( t ) = R α [ cos ( ψ R ( t ) + α ( t ) ) sin ( ψ R ( t ) + α ( t ) ) ] + P R ( t )
Pα(t) is also the destination point of the subtrajectory. Hence, there we have a new anchor point set that includes PR(t) and Pα(t) to produce subtrajectory. Figure 13 illustrates the subtrajectory set produced by the Pα(t) with different offset angles. However, the value of Rα depends on the current parameters and the kinematic constraint of the robot. Rα must meet the worst case when the robot is tending to turn right or left sharply, but the offset angle has value in the opposite site respect to the robot heading, i.e., the robot responds well at one-sided of the boundary of the range offset angle and does not at the other side. Experimentally, we can obtain Rα value by simulating the worst-case many times and choosing the shortest one that meets the case.
At every time step, robots will collect data and extract α values from WSM, create subtrajectory and continuously adjust until the obstacle is no longer within the sensor visibility. Once safe, the robot will return to the original trajectory. The summary of WSM used in the obstacle-avoidance task is illustrated in Figure 14.

7.3. Returning Main Trajectory by Reshaping Curve Algorithm

After the robot no longer see the observed obstacle, the robot will go back to the main trajectory. For easily getting back to the main trajectory, we will interpolate a retuning point on the path that has fixed distance ΔL from it to the current position of the robot. Let L(ui,iR) be the total distance which the robot has moved, L(ub, ib) is the arc length of curve from the initial point to the returning point that defined by Equation (35).
L ( u b , i b ) = L ( u R , i R ) + Δ L
By the approximating table and the Equations (26)–(28) we obtain the returning point position. In the current example, Figure 15 illustrates the re-path algorithm (illustrated in Figure 8) implementation when the robot exceeds the allowed position error.

8. Experiments and Discussions

The robot (Figure 16) performs experiments in the lab with the given pre-built map (Figure 17). The robot will be placed in two different scenarios are shown in Table 2. The robot starts at its station and moves to the workpiece-collection point. In the second scenario, the robot leaves the post-processing point to move to the storage station. The following picture shows a detailed description of the lab’s recorded map:
According to our distributions, we divide our experiments into three parts: path-planning performance, tracking trajectory by re-path algorithm performance and moving obstacle-avoidance performance.

8.1. Path Planning Performance

In the first experiment, we will investigate the processing speed, memory usage and length of paths produced by original A-heuristic and multi-agent A-heuristic path planning with the presence or absence of the significant points extraction algorithm (SPEA). The memory usage of each algorithm is measured by the number of checked spots.
In Table 3 and Table 4, respectively, the indices obtained by the algorithms through the two scenarios mentioned above are presented. The trajectories produced by fed the path point set of different algorithms to the C2 PCBC generator are also illustrated in Figure 18. In both scenarios, we see the superiority of the ability to optimize length of the path produced by the original algorithm even with or without the presence of SPEA compared to a multi-agent algorithm. However, A-heuristic in the presence of SPEA not only reduces the size of the path set, but also reduces the length of the path. Therefore, the variance of path length produced by two algorithms is no longer a problem. Furthermore, the presence of SPEA reduce the oscillation and curvature–magnitude of the path that presented in Figure 18. In the first scenario, when the robot uses a multi-agent algorithm, its processing time is reduced by 58.3%, but the number of spots checked is 3.2 times that of original A-heuristic.
In the second scenario, with average numbers of agents is 9.7, 119% more spot-checked and processing time only decreased by 11.1%, this is the case where the multi-agent algorithm performs not really well compared to the amount of memory it consumes.

8.2. Tracking Trajectory by Re-Path Algorithm Performance

As mentioned in Section 5, the re-path algorithm is employed to control the position error of the robot’s position compared to the desired position located on the initial trajectory. However, when the robot generates a subtrajectory, the main trajectory itself has a variation in curvature between it and the initial trajectory. The reason is keeping continuous curvature at Pback(t). If the curvature is greatly changed on the whole main trajectory, the robot will not be able to respond to the position error because of the difference between changed main trajectory and initial trajectory. However, the re-path algorithm only affects a small segment around Pback(t), which can be demonstrated by the series of curvature of main and reshaped trajectory respect to arc length in Figure 19 and Figure 20, according to the first and second scenario, respectively.
In both scenarios, the robot re-paths three times at the points where the accumulated position error (Figure 21 and Figure 22) exceeds the allowed deviation on its entire trajectory from start position to destination position.
In this experiment, the geometric parameters and kinematic limits of the robots are shown in the following Table 5.
Let εmax = 10 cm. In the first scenario, the position on the trajectory that has arc length L(u,i) ≈ 4 m has the corresponding curvature is −0.048 m−1 and the position has arc length L(u,i) ≈ 4.4 (m) has the corresponding curvature is 0.048 m−1, The average rate of change of curvature respect to arc length is approximately 0.24 m−2. The robot does not meet the desired velocity at this point, so it slips off the original trajectory. We can easily see the deviation in position and heading of the robot with respect to the desired position and heading at this point on the position error and heading error graphs. However, by the third and fourth re-paths, the robot gradually takes control of the error. In the second scenario, In the initial position, the robot has an initial heading in the opposite direction of the path, it is easy to see that the robots cannot meet the angular speed at this point, leading to large heading errors and position error in the beginning. By using the re-path algorithm, the robot quickly returns to its original trajectory by first and second re-paths. It illustrated in Figure 20.

8.3. Test Moving Obstacle-Avoidance Ability

To be able to verify the moving obstacle avoiding ability, in the first scenario, we simulate two obstacles with their initial position, velocity and size as Table 6.
Experimentally, we set the weight values when the robot detect collision is w1 = 0.3, w2 = 0.15, w3 = 0.33, w4 = 0.22. Figure 23 is a snapshot of the robot’s movement from the starting point to the target based on tracking the previously created trajectory in the first scenario. In the process of moving in a given trajectory, the robot must dodge these simulated obstacles. When no obstacle is presented, the robot moves along the given trajectory. If any obstacle that falls into the scanning zone then the robot will check for collision against that obstacle. In the given situation, both obstacles certainly collide with the robot when it maintains the original trajectory. Therefore, when these obstacles are detected by the robot, the robot is forced to update offset angle to avoid obstacles while establishing a subtrajectory from this parameter. The offset angle is constantly updated until the detected obstacle leaves the robot’s scanning zone. Right at that time, by re-path algorithm, the robot tries to return to the original trajectory. We also have some snapshot of the robot (Figure 24) that presents the performance of the robot in the second scenario without the presence of unforeseen obstacles.

9. Conclusions

In this study, we proposed series algorithms for navigating the autonomous service robot in an indoor environment in the presence of moving obstacles. These methods meet the requirements of real-time performance, flexibility. In tracking trajectory task, instead of doing the velocity plan for the robot, we present the reshape trajectory method. That method can perform in real time because it very flexible and does not cause many changes in curvature of the entire trajectory. In moving obstacle-avoidance task, our algorithm performs very well in many cases. However, in some specific cases, the robot is easily stuck in local minimum when optimizing WSM. The proposed algorithm is not strictly time-optimal or distance-optimal because the path constructed by the solution extracted from WSM is based on weight values that subjectively evaluated which makes it almost impossible to have the optimal path.
For a better version, further works may include the following topics:
-
Using neural networks to evaluate the weighted values of WSM;
-
In the path-planning algorithm, the final path does not have enough space for construct the Bézier curve in some specific case when path is constructed in a narrow area. We proposed the bubble generation method that same as in the [20]. They can easily constrain the extension of the Bézier curve around the original path;
-
Restricting the maximum velocity when the robot encounters sections of trajectory with large curvature.

Author Contributions

Conceptualization, N.T.T.; Formal analysis, P.G.L.; Investigation, P.G.L.; Methodology, N.T.T.; Project administration, N.T.T.; Supervision, N.T.T.; Visualization, P.G.L.; Writing–original draft, P.G.L.; Writing–review & editing, N.T.T. All authors have read and agreed to the published version of the manuscript.

Funding

This research is funded by Ho Chi Minh City University of Technology and Education, Vietnam.

Conflicts of Interest

The authors declare no conflict of interest

References

  1. Coste-Manière, È.; Simmons, R. Architecture, the Backbone of Robotic Systems. In Proceedings of the 2000 IEEE International Conference on Robotics & Automation, San Francisco, CA, USA, 24–28 April 2000. [Google Scholar]
  2. Li, G.; Yamashita, A.; Asama, H.; Tamura, Y. An efficient improved artificial potential field based regression search method for robot path planning. In Proceedings of the 2012 IEEE International Conference on Mechatronics and Automation, Chengdu, China, 5–8 August 2012; IEEE: Piscataway, NJ, USA, 2012. [Google Scholar]
  3. Taharwa, A.; Alweshah, M.; Al-Taharwa, I.; Sheta, A. A mobile robot path planning using genetic algorithm in static environment. J. Comput. Sci. 2008, 4, 341–344. [Google Scholar] [CrossRef] [Green Version]
  4. Saska, M.; Macas, M.; Přeučil, L.; Lhotská, L. Robot path planning using particle swarm optimization of Ferguson splines. In Proceedings of the 2006 IEEE Conference on Emerging Technologies and Factory Automation, Prague, Czech Republic, 20–22 September 2006; IEEE: Piscataway, NJ, USA, 2006. [Google Scholar]
  5. ElHalawany, B.M.; ABDEL-Kader, H.M.; Eldien, A.S.T.; Elsayed, A.E.; Nossair, Z.B. Modified a* algorithm for safer mobile robot navigation. In Proceedings of the 2013 5th International Conference on Modelling, Identification and Control (ICMIC), Cairo, Egypt, 31 August–2 September 2013; IEEE: Piscataway, NJ, USA, 2013. [Google Scholar]
  6. Sudhakara, P.; Ganapathy, V. Path Planning of a Mobile Robot using Amended A-Star Algorithm. Int. J. Control Theory Appl. 2016, 9, 489–502. [Google Scholar]
  7. Wu, M.; Dai, S.-L.; Yang, C. Mixed Reality Enhanced User Interactive Path Planning for Omnidirectional Mobile Robot. Appl. Sci. 2020, 10, 1135. [Google Scholar] [CrossRef] [Green Version]
  8. Kazem, B.; Hamad, A.H.; Mozael, M. Modified vector field histogram with a neural network learning model for mobile robot path planning and obstacle avoidance. Int. J. Adv. Comput. Technol. 2010, 2, 166–173. [Google Scholar]
  9. Yamada, T.; Sa, Y.L.; Ohya, A.; Yamada, T. Moving obstacle avoidance for mobile robot moving on designated path. In Proceedings of the 2013 10th International Conference on Ubiquitous Robots and Ambient Intelligence (URAI), Jeju, Korea, 30 October–2 November 2013; IEEE: Piscataway, NJ, USA, 2013. [Google Scholar]
  10. Ferrara, A.; Rubagotti, M. Sliding mode control of a mobile robot for dynamic obstacle avoidance based on a time-varying harmonic potential field. In Proceedings of the ICRA 2007 Workshop: Planning, Perception and Navigation for Intelligent Vehicles, Rome, Italy, 14 April 2007; Volume 160. [Google Scholar]
  11. Sharma, K.D.; Chatterjee, A.; Rakshit, A. A PSO–Lyapunov hybrid stable adaptive fuzzy tracking control approach for vision-based robot navigation. IEEE Trans. Instrum. Meas. 2012, 61, 1908–1914. [Google Scholar] [CrossRef]
  12. Mitrović, S.T.; Djurovic, Z.M. Fuzzy-Based Controller for Differential Drive Mobile Robot Obstacle Avoidance. In Proceedings of the 7th IFAC Symposium on Intelligent Autonomous Vehicle, Lecce, Italy, 6–8 September 2010; Volume 7. [Google Scholar]
  13. Kong, H.; Yang, C.; Li, G.; Dai, S.-L. A sEMG-Based Shared Control System With No-Target Obstacle Avoidance for Omnidirectional Mobile Robots. IEEE Access 2020, 8, 26030–26040. [Google Scholar] [CrossRef]
  14. Kunchev, V.; Jain, L.C.; Ivancevic, V.G.; Finn, A. Path planning and obstacle avoidance for autonomous mobile robots: A review. In International Conference on Knowledge-Based and Intelligent Information and Engineering Systems; Springer: Berlin/Heidelberg, Germany, 2006. [Google Scholar]
  15. Sgorbissa, A.; Zaccaria, R. Planning and obstacle avoidance in mobile robotics. Robot. Auton. Syst. 2012, 60, 628–638. [Google Scholar] [CrossRef]
  16. Duchon, F.; Babinec, A.; Kajan, M.; Beno, P.; Florek, M.; Fico, T.; Jurišica, L. Path planning with modified a star algorithm for a mobile robot. Procedia Eng. 2014, 96, 59–69. [Google Scholar] [CrossRef] [Green Version]
  17. Simons, D.P.; Scott, S.S. Arc-length reparameterization. U.S. Patent No. 6,115,051, 5 September 2000. [Google Scholar]
  18. Hwang, J.-H.; Arkin, R.C.; Kwon, D.-S. Mobile robots at your fingertip: Bezier curve on-line trajectory generation for supervisory control. In Proceedings of the 2003 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS 2003) (Cat. No. 03CH37453), Las Vegas, NV, USA, 27–31 October 2003; IEEE: Piscataway, NJ, USA, 2003; Volume 2. [Google Scholar]
  19. Yang, X.-S. Nature-inspired Optimization Algorithms; Elsevier: Amsterdam, The Netherlands, 2014. [Google Scholar]
  20. Zhu, Z.; Schmerling, E.; Pavone, M. A convex optimization approach to smooth trajectories for motion planning with car-like robots. In Proceedings of the 2015 54th IEEE Conference on Decision and Control (CDC), Osaka, Japan, 15–18 December 2015; IEEE: Piscataway, NJ, USA, 2015. [Google Scholar]
Figure 1. Flowchart of our proposed hybrid navigation system.
Figure 1. Flowchart of our proposed hybrid navigation system.
Applsci 10 03355 g001
Figure 2. Robot lies in the middle of spots and moves in a diagonal line.
Figure 2. Robot lies in the middle of spots and moves in a diagonal line.
Applsci 10 03355 g002
Figure 3. (a) Robot lies in the middle of the search window; (b) robot moves in a diagonal line without partial unobservable route.
Figure 3. (a) Robot lies in the middle of the search window; (b) robot moves in a diagonal line without partial unobservable route.
Applsci 10 03355 g003
Figure 4. (a) Number of steps that the window which has the lowest h score of open set converges the target spot; (b) total spots of open set and closed set during the search.
Figure 4. (a) Number of steps that the window which has the lowest h score of open set converges the target spot; (b) total spots of open set and closed set during the search.
Applsci 10 03355 g004
Figure 5. (a) Path point set is produced by A-Heuristic algorithm; (b) significant point set; (c) reduced significant point set by using regression search method.
Figure 5. (a) Path point set is produced by A-Heuristic algorithm; (b) significant point set; (c) reduced significant point set by using regression search method.
Applsci 10 03355 g005
Figure 6. Curvature of piecewise cubic Bézier curve (C2 PCBC) are continuous over the entire curve.
Figure 6. Curvature of piecewise cubic Bézier curve (C2 PCBC) are continuous over the entire curve.
Applsci 10 03355 g006
Figure 7. Cumulative errors of actual robot position respect to reference trajectory.
Figure 7. Cumulative errors of actual robot position respect to reference trajectory.
Applsci 10 03355 g007
Figure 8. Re-path algorithm flow chart.
Figure 8. Re-path algorithm flow chart.
Applsci 10 03355 g008
Figure 9. (a) Robot moves to the position where curvature is large enough, and deviates from desired trajectory; (b) After robot deviates from the trajectory, robot will create a subtrajectory to the back point, (c) The robot continues to fail to meet the acceleration condition caused by large curvature of the first created subtrajectory, the robot repeatedly create subtrajectory until it returns to original path.
Figure 9. (a) Robot moves to the position where curvature is large enough, and deviates from desired trajectory; (b) After robot deviates from the trajectory, robot will create a subtrajectory to the back point, (c) The robot continues to fail to meet the acceleration condition caused by large curvature of the first created subtrajectory, the robot repeatedly create subtrajectory until it returns to original path.
Applsci 10 03355 g009
Figure 10. Illustrating dead zone and scanning zone of the robot.
Figure 10. Illustrating dead zone and scanning zone of the robot.
Applsci 10 03355 g010
Figure 11. Context analysis flow chart.
Figure 11. Context analysis flow chart.
Applsci 10 03355 g011
Figure 12. Total weighted factor is recurred by WSM.
Figure 12. Total weighted factor is recurred by WSM.
Applsci 10 03355 g012
Figure 13. Visualization of sub-trajectories constructed by alternatives of the weighted-sum model.
Figure 13. Visualization of sub-trajectories constructed by alternatives of the weighted-sum model.
Applsci 10 03355 g013
Figure 14. The WSM flow chart.
Figure 14. The WSM flow chart.
Applsci 10 03355 g014
Figure 15. Visualization of re-pathed trajectory.
Figure 15. Visualization of re-pathed trajectory.
Applsci 10 03355 g015
Figure 16. Mobile platform for experiments.
Figure 16. Mobile platform for experiments.
Applsci 10 03355 g016
Figure 17. The map of lab pre-built by the robot.
Figure 17. The map of lab pre-built by the robot.
Applsci 10 03355 g017
Figure 18. (a) Trajectories produced by fed the path point set of different algorithms to the C2 PCBC generator in the first scenario, (b) in the second scenario.
Figure 18. (a) Trajectories produced by fed the path point set of different algorithms to the C2 PCBC generator in the first scenario, (b) in the second scenario.
Applsci 10 03355 g018
Figure 19. Trajectories’ curvature of the first scenario.
Figure 19. Trajectories’ curvature of the first scenario.
Applsci 10 03355 g019
Figure 20. Trajectory curvature of the second scenario.
Figure 20. Trajectory curvature of the second scenario.
Applsci 10 03355 g020
Figure 21. Left and right wheel angular speed, position error and heading error of the robot’s pose, with respect to desired pose on trajectory of the first scenario.
Figure 21. Left and right wheel angular speed, position error and heading error of the robot’s pose, with respect to desired pose on trajectory of the first scenario.
Applsci 10 03355 g021
Figure 22. Left and right wheel angular speed, position error and heading error of the robot’s pose, with respect to desired pose on trajectory of the second scenario.
Figure 22. Left and right wheel angular speed, position error and heading error of the robot’s pose, with respect to desired pose on trajectory of the second scenario.
Applsci 10 03355 g022
Figure 23. Reference trajectory of the robot is the blue curve, detected obstacle has red circular boundary, non-observed obstacle has green circular boundary.
Figure 23. Reference trajectory of the robot is the blue curve, detected obstacle has red circular boundary, non-observed obstacle has green circular boundary.
Applsci 10 03355 g023
Figure 24. Snapshot series of the trajectory tracking performance of the robot in workspace.
Figure 24. Snapshot series of the trajectory tracking performance of the robot in workspace.
Applsci 10 03355 g024
Table 1. Data for converting between arc length and curve parameter.
Table 1. Data for converting between arc length and curve parameter.
vul(u,v)L(u,v)
0000
00.010.010.01
00.022.84272.8427
00.035.67925.6792
00.048.53678.5367
00.0511.385811.3858
....
....
300687.7763
30.010.001687.7773
30.021.8897689.6662
30.033.7465691.5228
....
....
30.98115.2653803.0417
30.99116.2936804.07
31117.343805.1194
Table 2. Robot’s task for each scenario.
Table 2. Robot’s task for each scenario.
Scenario #Initial PositionInitial HeadingDestination PositionDestination Heading
1(560, 120)90 degree(900, 450)0 degree
2(900, 250)−90 degree(500, 625)0 degree
Table 3. Indices obtained by original A-heuristic algorithm and multi-agent A-heuristic algorithm with or without the presence of a reduction path algorithm in the first scenario.
Table 3. Indices obtained by original A-heuristic algorithm and multi-agent A-heuristic algorithm with or without the presence of a reduction path algorithm in the first scenario.
AlgorithmProcessing Time (ms)Length of Path (cm)Total Checked Spot (Spot)Path Set Size (Spot)
Original A heuristics12603.190925139
Multi-agent A heuristics5657.783980440
Original A heuristics with significant points extraction algorithmN/A601.83997N/A7
Multi-agent A heuristics with significant points extraction algorithmN/A602.94867N/A6
Table 4. Indices obtained by original A-heuristic algorithm and multi-agent–heuristic algorithm with or without the presence of a reduction path algorithm in the second scenario.
Table 4. Indices obtained by original A-heuristic algorithm and multi-agent–heuristic algorithm with or without the presence of a reduction path algorithm in the second scenario.
AlgorithmProcessing Time (ms)Length of Path (cm)Total Checked Spot (Spot)Path Set Size (Spot)
Original A heuristics18692.577961840
Multi-agent A heuristics16704.1758141640
Original A heuristics with significant points extraction algorithmN/A666.4103N/A5
Multi-agent A heuristics with significant points extraction algorithmN/A668.11456N/A5
Table 5. Robot geometric parameters and kinematic limits.
Table 5. Robot geometric parameters and kinematic limits.
ParameterValue
R R 0.4 m
l w 0.36 m
r w 0.06 m
θ ˙ max 220 rpm
θ ¨ max 2.2 rad/s2
Table 6. Virtual obstacle parameters for testing moving obstacle avoiding ability in first scenario.
Table 6. Virtual obstacle parameters for testing moving obstacle avoiding ability in first scenario.
1st Obstacle2nd Obstacle
Initial position(585, 400)(850, 300)
Velocity(−0.1, −0.5)(0, 0.1)
Size (cm)4060

Share and Cite

MDPI and ACS Style

Gia Luan, P.; Thinh, N.T. Real-Time Hybrid Navigation System-Based Path Planning and Obstacle Avoidance for Mobile Robots. Appl. Sci. 2020, 10, 3355. https://doi.org/10.3390/app10103355

AMA Style

Gia Luan P, Thinh NT. Real-Time Hybrid Navigation System-Based Path Planning and Obstacle Avoidance for Mobile Robots. Applied Sciences. 2020; 10(10):3355. https://doi.org/10.3390/app10103355

Chicago/Turabian Style

Gia Luan, Phan, and Nguyen Truong Thinh. 2020. "Real-Time Hybrid Navigation System-Based Path Planning and Obstacle Avoidance for Mobile Robots" Applied Sciences 10, no. 10: 3355. https://doi.org/10.3390/app10103355

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