Next Article in Journal
Numerical and Experimental Investigation of the Temperature Rise of Cutting Tools Caused by the Tool Deflection Energy
Next Article in Special Issue
Investigation on the Finishing Characteristics of a Magnetic Abrasive Finishing Process with Magnetic Abrasive Slurry Circulation System
Previous Article in Journal
Determination of Heat Transfer Coefficient from Housing Surface of a Totally Enclosed Fan-Cooled Machine during Passive Cooling
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Motion Planning and Control of Redundant Manipulators for Dynamical Obstacle Avoidance †

Department of Industrial Engineering and Mathematical Sciences, Polytechnic University of Marche, 60131 Ancona, Italy
*
Author to whom correspondence should be addressed.
This paper is an extension of the paper presented at the the 26th Jc-IFToMM Symposium (2020) 3rd International Jc-IFToMM Symposium entitled “On-line obstacle avoidance with smooth path planning for redundant manipulators”.
Machines 2021, 9(6), 121; https://doi.org/10.3390/machines9060121
Submission received: 6 May 2021 / Revised: 9 June 2021 / Accepted: 16 June 2021 / Published: 18 June 2021
(This article belongs to the Special Issue Advances of Japanese Machine Design)

Abstract

:
This paper presents a framework for the motion planning and control of redundant manipulators with the added task of collision avoidance. The algorithms that were previously studied and tested by the authors for planar cases are here extended to full mobility redundant manipulators operating in a three-dimensional workspace. The control strategy consists of a combination of off-line path planning algorithms with on-line motion control. The path planning algorithm is used to generate trajectories able to avoid fixed obstacles detected before the robot starts to move; this is based on the potential fields method combined with a smoothing interpolation that exploits Bézier curves. The on-line motion control is designed to compensate for the motion of the obstacles and to avoid collisions along the kinematic chain of the manipulator; this is realized using a velocity control law based on the null space method for redundancy control. Furthermore, an additional term of the control law is introduced which takes into account the speed of the obstacles, as well as their position. In order to test the algorithms, a set of simulations are presented: the redundant collaborative robot KUKA LBR iiwa is controlled in different cases, where fixed or dynamic obstacles interfere with its motion. The simulated data show that the proposed method for the smoothing of the trajectory can give a reduction of the angular accelerations of the motors of the order of 90 % , with an increase of less than 15 % of the calculation time. Furthermore, the dependence of the on-line control law on the speed of the obstacle can lead to reductions in the maximum speed and acceleration of the joints of approximately 50 % and 80 % , respectively, without significantly increasing the computational effort that is compatible for transferability to a real system.

1. Introduction

Nowadays, robots are increasingly asked to work in unstructured environments. In many cases, they are supported by sensor-based safety systems, avoiding fences that typically isolate the cell workspace within the workshop. Moreover, the trend toward collaborative robotics portends to a workshop layout where robots and humans share the workspace and collaborate in many operations, in a dynamical and unforeseeable scenario. In addition to dedicated hardware and design principles, collaborative robotics implies specific control strategies to ensure safety [1,2]. In this sense, collision avoidance control techniques represent a powerful means of improving the safety and flexibility of robots. A number of papers are available in the literature on path planning and obstacle avoidance for mobile robots [3], which is a very common problem. A more complex problem is the collision avoidance for industrial manipulators, which suffer from the limitations of the workspace and problems of singularity. In this case, redundant manipulators offer greater dexterity than traditional manipulators, which aids in the development of task-oriented control strategies taking advantage of the additional degrees of freedom. Thus, redundant manipulators are the best candidates for high dexterity tasks with collision avoidance capability [4,5]. Moreover, redundancy can also be exploited with standard manipulators if some of the degrees of freedom of the end-effector, e.g., the orientation angles, can be kept free during motion.
Thus, an overall control strategy for a manipulator working in a dynamic environment can be conceived as the combination of:
  • An off-line path planning algorithm, which plans the trajectory of the robot’s end-effector taking into account the possible presence of disturbing obstacles, modifying the path based on the positions of the obstacles before the motion starts;
  • An on-line motion control algorithm, which controls in real-time the robot compensating for obstacles that are moving, or new obstacles entering the workspace;
  • A redundancy control strategy that exploits the dexterity of the manipulator to avoid collisions between obstacles and the kinematic chain of the manipulator;
  • A robust technique for the avoidance of singular configurations during motion.
Dealing with motion planning for obstacle avoidance, several methods are available in the literature [6], such as Rapidly-exploring Random Trees (RRT) [7,8], grid-based algorithms [9,10] or Batch Informed Trees (BIT) and Model Predictive Control (MPC) [11]. A very common approach consists in defining artificial potential fields, which drive the robot to the target inside the workspace [12,13,14]. The result of the potential fields is a set of forces, attractive toward the goal and repulsive from the obstacle regions. Typically, such forces are associated with velocities applied to the end-effector of the manipulator; then, the trajectory can be obtained by numerical integration.
A further problem in optimal path planning for automation and robotics is the generation of smooth trajectories: an optimal algorithm for trajectory generation must guarantee smoothness in terms of position and velocity to be implemented in the controller of a real system. The use of smooth curves, e.g., the Bézier curves, can help solve this problem, as proposed by the authors in [15]: several examples of applications can be found in different fields, such as automated vehicle guidance [16,17], aerial autonomous vehicles [18] or spherical parallel manipulators [19,20].
The same principle of repulsive velocities generated by obstacles can be used to avoid collisions between obstacles and control points along the kinematic chain of the manipulator: in addition to the motion imposed to end-effector, a repulsive velocity vector can be applied to the point of the robot that is closer to one of the obstacles, adding a task to the control system [21,22]. Such an approach is typically applied to redundant manipulators [23,24], where additional tasks can be assigned maintaining the trajectory of the end-effector. Furthermore, the entity of the repulsive velocity can be thought in general as a function of several parameters besides obstacle/robot positions, e.g., the relative speed [25] or other energetic criteria [26].
The authors studied this kind of approach in [15] for a planar case; in addition to the standard method, a modified repulsive velocity was introduced, improving the capability of the algorithm to compensate for dynamic obstacles.
Inspired by the background described above and using of previous research conducted by the authors for the planar case, this study presents an extension of the proposed algorithms to a three-dimensional workspace and redundant manipulators with full mobility. In addition, a strategy based on the least-square damped method for the inversion of the Jacobian matrices is introduced in order to avoid passages through points which are too close to singular configurations. Finally, once the validity of algorithms is verified, an estimation of the computational time required to execute the path planning and motion control loop is given, proving that the proposed control technique is able to be implemented in a real system.
The rest of the paper is organized as follows: the algorithms for off-line path planning and on-line motion control are described in Section 2 and Section 3, respectively; results obtained by a series of simulations are described in Section 4; a discussion on the computational effort required on the issues related to transferability of the control law to a real system is presented in Section 5, whereas conclusions are drawn in Section 6.
In summary, this paper presents a general framework for path planning and motion control with collision avoidance for a redundant 7-DOF manipulator in a dynamically varying workspace. The algorithms are fine-tuned and verified by means of simulations, which also provide insight into the computational effort required, in line with the requirements of industrial robot controllers.

2. Off-Line Path Planning

The trajectory planning algorithm used to define the motion x e ( t ) of the end-effector, proposed by the authors in [15,27], is extended in the present paper to the 3D case. The generated path allows to reach the target position and to avoid the obstacles that are inside the workspace before the motion of the robot starts. The algorithm is based on the definition of potential fields that generate repulsive and attractive velocity components, defined v r e p and v a t t , respectively, which drive the end-effector E following the minimum potential path towards the goal. As shown in Figure 1, S is the initial position of the end-effector, G is the goal and O i are the obstacles, with their region of influence outlined by their radius r . Moreover: d O = E O i and d G = G E . Based on [28], Equation (1) defines attractive and repulsive velocities as:
v a t t = v a t t d G r d G < r v a t t d ^ G d G r v r e p = v r e p d O 2 1 d O 1 r d O d O < r 0 d O r
where the symbol indicates the gradient operator. Norms of velocities must be set based on the type of application; as an example, values used in the simulations presented in the following of this paper are v r e p = 10 m / s and v a t t = 1 m / s .
The end-effector trajectory can be found by numerical integration of the resulting velocity:
x ˙ e = v r e p + v a t t x e ( t + d t ) = x e ( t ) + x ˙ e ( t ) d t
As a consequence, the end-effector position is iteratively updated by Equation (2) in accordance with the velocity imposed at each time step. The procedure ends when the distance between the end-effector and the target is lower than a predefined threshold, which is set at 10 5 m for the examples shown in this paper. Then, an interpolation with a fifth order polynomial law is used to generate a timed motion law over the path previously found. Nevertheless, the trajectory resulting from Equations (1) and (2) is typically characterized by short-radius curves and sharp corners that may originate high accelerations and vibration problems, as shown in the example of Figure 2: here, two obstacles are interposed between the start and goal points preventing the motion over the ideal linear trajectory; the planning algorithm generates the black curve that remains outside the region of influence of the obstacles in all its points, but presents fast changes of directions in two points, i.e., where the trajectory meets the influence spheres of the obstacles. An interpolation procedure that exploits a smoother type of curve, e.g., a Bézier curve, can be used to solve the problem. In more detail, given n + 1 points P 0 , P 1 , , P n , where n is the power of the Bézier curve, the latter is defined as a parametric function of the variable s as:
B ( s ) = i = 0 n n i P i ( 1 s ) n i s i , s [ 0 , 1 ]
without any loss of generality, let’s consider a third order Bézier curve:
B = P 0 ( 1 s ) 3 + 3 P 1 s ( 1 s ) 2 + 3 P 2 s 2 ( 1 s ) + P 3 s 3
The points P 0 and P 3 being coincident with the starting and goal points, respectively, the fitting procedure seeks for points P 1 and P 2 generating the curve B that best approximates the original one with a least-square metric. Thus, an optimization problem must be solved in order to find the six variables defining points P 1 and P 2 which minimize the quadratic error between the original path and the Bézier curve. A closed-form solution to the problem can be found manipulating Equation (4) as follows:
B i = ( 1 s ) 3 3 s ( 1 s ) 2 3 s 2 ( 1 s ) s 3 P 0 i P 1 i P 2 i P 3 i T = = ( 1 s ) 3 s 3 P 0 i P 3 i T 3 s ( 1 s ) 2 3 s 2 ( 1 s ) P 1 i P 2 i T , i = x , y , z
B T = ( 1 s ) 3 s 3 P 0 P 3 T + 3 s ( 1 s ) 2 3 s 2 ( 1 s ) P 1 P 2 T
If the curvilinear abscissa s is discretized in m samples, the trajectory x e becomes a set of m points. Thus, Equation (6) can be written m times for the points B j , j = 1 m , assuming the form:
M = S 1 C 1 + S 2 C 2
where:
M = B 1 B m T S 1 = ( 1 s 1 ) 3 s 1 3 ( 1 s m ) 3 s m 3 S 2 = 3 s 1 ( 1 s 1 ) 2 3 s 1 2 ( 1 s 1 ) 3 s m ( 1 s m ) 2 3 s m 2 ( 1 s m )
C 1 = P 0 P 3 T C 2 = P 1 P 2 T
A closed-form solution for the optimal set of coefficients C 2 can be easily found manipulating Equation (7) and substituting the matrix M with the analogous matrix X that is built with the points belonging to the trajectory x e found with the potential field algorithm:
C 2 = S 2 ( X S 1 C 1 ) X = x e , 1 x e , m T
where † represents the pseudo-inverse operator according to the Moore-Penrose definition, which intrinsically provides the coefficients of the curve that best fits the original trajectory by minimizing the least squares error. An example is given in Figure 2 in order to show the effect of the smoothing procedure: given the start and goal points and two obstacles preventing from the linear trajectory, the potential fields method described by Equations (1) and (2) gives the path plotted in black, whereas the interpolation procedure described by Equations (3)–(10) returns the Bézier curve plotted in red. A deeper comparison is given by Figure 3, where the Cartesian components of position and velocity of the end-effector are plotted versus time: the path directly obtained by the potential fields algorithm (black plot) presents cusps and discontinuities in the position and velocity profiles, respectively, whereas the trajectory related to the Bézier curve (red plot) is smooth both in position and velocity; thus, it is feasible for it to be assigned to a real manipulator. Bézier curves of higher order have been also tested, but they suffer from too sharp curvatures and high computational times; thus, they are not suitable for the purpose.
When the potential fields approach is used in path planning a particular condition must be taken into account: as shown in Figure 4a in a simplified planar scheme, when an obstacle lies exactly on the segment joining the end-effector to the goal point, the attractive and repulsive velocities act in contrast to each other and the end-effector rebounds from the obstacle along such segment, without accomplishing the task. The proposed algorithm overcomes the problem as follows: when the aligning condition between E , O and G is verified, an infinitesimal component of velocity v d e v orthogonal to v a t t is added in order to force the trajectory to exit from the stagnation; among infinite directions that can be assigned to v d e v orthogonal to v a t t , a subset of four of them is selected (aligned with Cartesian axes, with positive or negative directions), whereas its magnitude is constant and predefined. The effect of the deviatoric velocity is to bring the end-effector out of the stagnation line. Obviously, for each one of the selected directions the resulting path is different. Thus, the shortest one is considered for further steps. The example shown in Figure 4b gives a three-dimensional representation of the problem and shows the trajectories obtained with each one of the four different directions assigned to v d e v ; among them the shorted one (blue curve) is chosen.
All the issues discussed above in this section concerned the planning of the Cartesian position of the end-effector of the manipulator, that is, the generation of the motion laws x ( t ) , y ( t ) , z ( t ) . A different strategy must be defined to generate a smooth transition between the initial and final orientation of the end-effector: if the orientation at the target point is different from the initial one, a linear transition with the same timing law used for the position is defined for the three parameters used for the representation, e.g., the Euler angles.

3. On-Line Motion Control

Starting from the results obtained by the authors in [15], the mentioned algorithms are implemented in the present work for a redundant manipulator with full mobility, i.e., the KUKA LBR iiwa 14 R820 robot. The kinematic scheme of the manipulator is shown in Figure 5. The pose of the end-effector in the Cartesian space is defined by the vector x = [ x y z α β γ ] T , where the last three components are the Euler angles according to the Z Y Z convention. The seven rotations related to the revolute joints of the serial kinematic chain form the joint space position vector, defined as q = [ θ 1 θ 2 θ 3 θ 4 θ 5 θ 6 θ 7 ] T . Thus, the kinematic chain of the manipulator has a redundant degree of freedom with respect to the task. Besides the end-effector E , a total of 13 control points ( A , B , C , A 1 , A 2 , A 3 , A 4 , B 1 , B 2 , B 3 , B 4 C 1 , C 2 ) belonging to the kinematic chain characterizes the manipulator, as shown in the bottom picture of Figure 5.
The forward kinematics of the manipulator can be described by:
x = f ( q )
x ˙ = v ω = J p J o q ˙ = J ( q ) q ˙
In the previous equations f represents the expression of the position forward kinematics and J is the ( 6 × 7 ) analytic Jacobian composed by the position and orientation Jacobian matrices J p and J o , each one of dimensions ( 3 × 7 ) ; the velocity vector x ˙ is composed by the linear velocity v and the angular velocity ω , whose expressions, accordingly to the Euler angles α β γ Z Y Z representation, are given by:
v = x ˙ y ˙ z ˙ T w = γ ˙ cos α sin β β ˙ sin α β ˙ cos α + γ ˙ sin α sin β α ˙ + γ ˙ cos β T
Due to redundancy, the inverse position kinematics problem is not uniquely defined, but it can be workedout by the following differential formulation:
q ˙ = J x ˙ + N q ˙ 0
q ( t + d t ) = q ( t ) + q ˙ ( t ) d t
The terms of Equation (14) are defined as follows: q ˙ 0 is the joint null space velocity, whose effect is to generate internal motions leaving the pose of end-effector unchanged; J = J T ( JJ T ) 1 is the pseudoinverse of the Jacobian matrix J ; N = I J J is the orthogonal projection into the null space of J .
The inverse kinematic problem formulated in Equation (14) suffers from numerical problems due to the inversion of the Jacobian matrix when the manipulator is near to a singular configuration, i.e., when the singular values of J tend to zero. In order to avoid singularity problems, the use of the well known damped least-square method was applied [29]. Such a method consists in the substitution of the pseudoinverse of the Jacobian J by:
J * = J T ( JJ T + λ 2 I ) 1
where λ represents a damping factor that confers a better numerical conditioning to the inversion problem. The value of λ should be a compromise between accuracy (low value) and numerical robustness (high value). An efficient way to determine λ is to define it as a function of the smallest singular value s m i n of J :
λ 2 = 0 s m i n ϵ 1 s m i n ϵ 2 λ m a x 2 s m i n < ϵ
In this way the effect of the approximation vanishes when the smallest singular valuer is greater than a threshold ϵ , where λ λ m a x when s m i n 0 , being λ m a x and ϵ tunable parameters of the algorithm. This kind of approximation introduces a position error that must be subsequently recovered by a proportional term in the control law, as typically done in Closed-Loop Inverse Kinematics (CLIK) control laws [30].
In addition to the basic control law, an obstacle avoidance strategy is introduced: inspired by the null space methods for the control of redundant manipulators [21], an additional velocity vector is assigned to the control point of the robot which is the closest to one of the obstacles within the workspace, so that the control point can move away form the obstacle, while the motion of the end-effector is not affected. In more detail, referring to the Figure 6, the couple of points P r and P o at the minimum distance d o is identified at each time step. The region of influence of each control point is delimited by the radius r. If at a certain time step during the motion the condition d o < r is verified, a repulsive velocity x ˙ 0 is imposed to the relative control point along the direction of d o . Being the manipulator characterized by one redundant DOF, only one repulsive velocity vector can be assigned at each time step, thus the point to which it is assigned may change over time with the criterion of minimum distance from one of the obstacles. Such a point can be also the end-effector: besides the velocity vector x ˙ e assigned by the off-line path planning in order to describe the desired trajectory, the repulsive velocity vector can be applied to E , modifying its trajectory, if the position of an obstacle changes from its initial state or a new obstacle enters the workspace, interfering with the motion of E . In this case, the position of the end-effector drifts from the originally planned trajectory, originating a position error analogous to the one related to the damped least-square approximation for the inversion of the Jacobian matrix. Nevertheless, the CLIK control law can be exploited to recover the error.
In terms of equations, the following expressions (18) and (19) must be imposed in order to assign the two velocity tasks above described:
J q ˙ = x ˙ e
J 0 p q ˙ = v 0
where J 0 p represents the ( 3 × 7 ) upper part of the Jacobian matrix J 0 associated to the velocity of the point P r .
Thus, Equation (14) can be modified in [31,32]:
q ˙ = J * x ˙ c + ( J 0 p N ) * ( v 0 J 0 p J * x ˙ e )
where N * = I J * J , x ˙ c = x e ˙ + K e is the corrected end-effector velocity, K a positive-defined gain matrix (for simplicity defined as K = k e I ) and e is the position error between the desired position x e and the actual position x . The error e can be represented by [29]:
e = e p e o = p e p 1 2 n × n e + s × s e + a × a e
where the translation error is given by the ( 3 × 1 ) vector e p and the orientation error is given by the ( 3 × 1 ) vector e o . The end-effector position is expressed by the ( 3 × 1 ) position vector p , whereas its orientation by the ( 3 × 3 ) rotation matrix R = [ n s a ] , with n , s , a being the unit vectors of the end-effector frame.
The first term of Equation (20) guarantees the exact velocity of the end effector with minimum joints speed. The second term drives the motion of the point P r of the robot, satisfying the collision avoidance additional task. The choice of x ˙ 0 is a critical point of the algorithm. The proposed strategy is to change x ˙ 0 according to the distance from the obstacle. To avoid a discontinuity and give smoothness to the motion, two weighting coefficients, a h and a v , are introduced:
v 0 = a v v r e p d ^ o
q ˙ = J * x ˙ c + a h ( J 0 p N ) * ( a v v r e p d ^ o J 0 p J * x ˙ e )
Thus, a nominal repulsive velocity v r e p is modulated by a v as a function of the distance d o , whereas a h acts with a weight that balances the effect of the homogeneous solution (related to the collision avoidance) with respect to the total.
In more detail, let r be the control distance that defines the region of influence of a control point, r m i n the distance under which no action is possible, and r m an intermediate critical distance between r m i n and r. No influence of the obstacle is desired if d o > r , whereas the algorithm fails (the robot stops) if d o < r m i n . Between these limits the weighting coefficients vary continuously from 0 to 1, as shown in Figure 7, accordingly to the following expressions [4]:
a v = d o r m r m i n r m 2 d o < r m 0 d o r m
a h = 1 d o r m 1 2 1 cos π d o r m r r m r m < d o < r 0 d o r
In order to improve the ability of the algorithm to avoid moving obstacles, a modification of the control law expressed by Equation (23) can be introduced changing the definition of the repulsive velocity [15]: it is reasonable that not only the position, but also the velocity of an obstacle should influence the control of the robot. As an example, if the end-effector moves toward an obstacle having an orthogonal velocity, it is preferable to modify the trajectory of the end-effector pushing it in the direction opposite to the obstacle velocity. Thus, if the end-effector is the control point closest to the obstacle, the repulsive velocity vector v 0 is modified as follows:
v 0 * = v 0 d ^ o * = α v v r e p d ^ o k v v o b s 1 + k v 2 v o b s 2
where, as described in Figure 8, v o b s is the obstacle velocity, v 0 is the repulsive velocity along the direction of d o , k v is a gain term and v 0 * is the modified repulsive velocity applied to the end-effector in combination with the planned velocity v . As a consequence, the direction of the repulsive velocity is modified, whereas its magnitude does not change; furthermore, for k v = 0 , the effect vanishes.

4. Results

The algorithms presented in the previous sections were tested by Matlab simulations over a wide range of conditions. In this section, five different examples are shown. The first three examples help to understand the behavior of the control law in different conditions, with fixed or moving obstacles interfering with the manipulator in different points of the kinematic chain; a common set of parameters is used (Table 1) and a threshold θ ˙ m a x is imposed for the angular velocity of all joints. Thus, if the control asks for a joint speed higher than θ ˙ m a x , the velocity saturates avoiding dangerous situations, whereas the consequent positioning error is recovered by means of the corrective proportional term during the following part of the motion.
Two other examples are then discussed to demonstrate the effectiveness of the contributions introduced by the authors with respect to standard methods: Section 4.4 shows the advantages of trajectory interpolation using Bézier curves, while Section 4.5 shows how the modified repulsive velocity described in Section 3 is able to improve the response of the control in case of moving obstacles.

4.1. Example 1

In the first example the robot is fixed while a dynamic obstacle is interfering with the end-effector. The obstacle moves linearly in the horizontal plane along y direction, with a speed of 0.25 m / s . Figure 9 shows eight steps of the motion: when the obstacle reaches the region of influence of the end-effector point of the robot the control reacts keeping the obstacle outside from the safety sphere with radius r m i n . Then, the positioning and orientation error generated by the control is suddenly recovered once the obstacle overcomes the region of influence.
Figure 10 traces the trend over time of the minimum distance between the obstacle and the robot: it is visible how the anti-collision control is activated once the distance becomes lower than the threshold r that delimits the region of influence around the robot control point.
The corresponding profiles of joint rotations and speeds are shown in Figure 11: the effect of the obstacle is visible at t = 0.3 s , where the joint speed curves suddenly increase their magnitude, reaching in some case the saturation in the middle part of the motion. The effect of the redundancy of the kinematics is clearly visible looking at the final values of joint angles, which are different from the initial ones, despite the Cartesian pose of the manipulator is the same.

4.2. Example 2

In this example the obstacle moves again linearly in the horizontal plane along y direction, with a speed of 0.25 m / s , but, differently from the previous case, the end-effector position is not altered by the obstacle. As shown in Figure 12, the risk of collision occurs in a point of the robot belonging to an intermediate link of the manipulator. Thanks to the redundancy of the kinematic chain, the control is able to reconfigure the manipulator without changing the pose of the end-effector.
In this case, the plot of Figure 13 regards the distance between the obstacle and control points belonging to the 4th and 5th links of the kinematic chain of the manipulator, whereas the end-effector position does not influence the control.
Due to the saturation of the speed of the third joint (Figure 14), a small motion of the end-effector can be noticed ( t = 0.8 s ), which however is quickly recovered by the control. In a similar case, where the task could be performed without speed saturation, the absence of motion of the end-effector would be guaranteed.

4.3. Example 3

The third example, more complex, presents two obstacles (Figure 15). The first, fixed, is located under the linear path of the robot. Since its proximity to the path is less than the radius r of the end-effector’s region of influence, the off-line trajectory planner generates a Bézier curve that avoids the obstacle by passing over it. Once the trajectory is assigned and the motion of the manipulator starts, a second obstacle, dynamic, moves linearly at the speed of 0.25 m / s along a path that intersects the kinematic chain of the robot.
The effect of the second obstacle is visible in Figure 16 at approximately t = 0.8 s , when the distance rapidly decreases before the control readily flattens the curve. Such effect is clearly visible also in Figure 17, where a sudden change of the velocity profiles is visible at the same instant. Despite the interference of the two obstacles and the speed saturation for some joints, the control is able to execute the task.

4.4. Example 4

This example presents three simulations showing the differences resulting from different path generation methods. As shown in Figure 18, the robot is asked to move on a linear path, but two fixed obstacles prevent this trajectory by violating the safety distance. Therefore, an alternative path is required. Starting from the standard method of Potential Fields (PF, Figure 18a), two other strategies are adopted, i.e., an interpolation with a third (PF + 3BI, Figure 18b) and fourth (PF + 4BI, Figure 18c) order Bézier curve, respectively, according to the method described in Section 2.
The trajectory plots show that the first method is able to respect the safety region, so that the trajectory executed by the robot coincides with the planned one. On the other hand, the trajectory has two very sharp curves, which result in high accelerations. The second method allows for smoother curves, reducing accelerations. Furthermore, even if the predicted trajectory slightly violates the safety zone of the obstacles, the on-line anti-collision control is able to correct the motion with a small deviation. When a fourth order Bézier curve is used, the deviation between planned and executed trajectories is smaller, which means that anti-collision control is almost unnecessary; however, the curves are sharper than in the 3rd order case.
In order to compare the effort required of the motors in the three different cases, the norm of the joints angular velocity vector | | q ˙ | | and the norm of the joints angular acceleration vector | | q ¨ | | are analyzed, and their maximum values assumed during the motion, | | q ˙ | | m a x and | | q ¨ | | m a x , respectively, are used as indexes. Table 2 confirms the aforementioned considerations. With the same motion time T, the PF method gives a path length L larger than PF + 3BI and PF + 4BI, which give a reduction in the order of 3%. Dealing with the angular velocity, the three methods result in quite similar maximum values (differences in the order of 3%), but the advantage of interpolation is much evident in terms of acceleration: peaks of angular acceleration are in this case reduced of about 90% with respect to the potential fields method without interpolation, which results in much less torque and power by the motors. This important advantage is not affected by a longer computational time, which is only marginally higher in the PF + 3BI (+11.1%) and PF+4BI (+14.8%) cases.

4.5. Example 5

The last example of this section is aimed at highlighting the effect of the repulsive speed in its traditional definition compared with the one introduced by the authors, which takes into account the velocity of the moving obstacle according to Equation (26).
Figure 19 shows the test case: the robot is moving linearly on the horizontal plane while an obstacle is moving on the same plane in the orthogonal direction, intersecting the robot planned trajectory in the midpoint. As a consequence, the on-line control acts once the obstacle enters the safety region of the end-effector. The response of the control is different in the three cases presented: the gain term k v , introduced in Equation (26), is set to 0 in Figure 19a, whereas Figure 19b,c refers to k v = 100 and k v = 500 , respectively. In other words, in the first case the repulsive speed is defined solely on the basis of the position of the obstacle, while the speed of the obstacle is considered with increasing influence in the two following cases.
When k v = 0 , the robot tries to avoid the collision by deviating its trajectory in the same direction as the speed of the obstacle; the effect is that the obstacle pushes the end-effector further and further away from its planned path, until the term proportional to the positioning error is able to recover the drift. Furthermore, looking at the second frame of the motion in Figure 19a, the control is not able to avoid the collision, which means that in a real implementation the robot should be stopped at this stage, or more precisely at the first moment when the safety limit is crossed. In the case of k v = 100 the end-effector initially tries to avoid the obstacle by deviating along its speed, but after a while the direction of the end-effector is reversed and the obstacle is successfully avoided on the upstream side. The effect is even more evident with k v = 500 , when the control is able to deviate the end-effector to the upstream side of the obstacle since the first instant of the interaction.
A more detailed comparison can be done based on the data collected in Table 3: as expected, the case with k v = 0 is the worst one in terms of length of the path, maximum joints speed, and most of all in terms of maximum angular acceleration of joints. Increasing the gain k v all the indexes reduce, especially the one related to the acceleration. The best performance is found for k v = 500 , whereby the minimum path length is obtained with, at the same time, a reduction of about 80% of the maximum acceleration of the joints and a reduction of about 49% of the maximum speed of the joints. On the other hand, the computation time required to perform an iteration of the control loop is substantially equivalent; for the fourth case with k v = 1000 there is only a slight increase of about 5%. It is worth pointing out that high values of k v may not lead to more beneficial motions. In fact, looking at the fourth row of Table 3 referring to k v = 1000 , an improvement is obtained compared to the case with k v = 0 , but it is a worse result than the case with k v = 500 . Therefore, the optimal value of k v must be found case by case, according to the expected speed of the potential obstacles, the speed of the manipulator itself and other variables related to the working conditions.

5. Discussion

The simulations presented in the previous section are intended to verify the correctness of the method and to investigate the computational effort needed to implement the related algorithms in a real system. As a matter of fact, the final objective of this research is to transfer the control framework to a real system, now under construction in laboratory, where the robot will be equipped with a vision system composed by three depth cameras (Intel RealSense D455), able to acquire the surrounding environment and extrapolate the position of objects and humans within the workspace. Fixed obstacles simulated in this study can be thought of as fixed objects inadvertently left inside the workspace, such as furniture elements or mechanical tools, whereas dynamic obstacles may represent humans operating in the shared workspace.
What is expected as a critical issue in the implementation on the real system is the speed of execution of the control loop. Based on the results presented in this paper, referring in particular to the most demanding case of example 3, it can be summarized that for the execution of the off-line path planning algorithm the average computational time is approximately 0.15   s , whereas the on-line motion control is able to run with a cycle time of approximately 2 × 10 3 s , comparable with rates typically used in the communication between external controllers and main controllers of robots. Furthermore, a standard laptop (i7 CPU @1.8 GHz, 16 GB RAM) was used for simulations; thus, a reduction of computational times can be expected if a more performing hardware is used.

6. Conclusions

In this paper, an obstacle avoidance strategy for robots moving in dynamically varying environments is presented and verified by simulation. Two main aspects characterize the proposed algorithms: first, the trajectory planned by the potential fields method is smoothed using a best-fit interpolation with Bézier curves; second, a modified repulsive velocity for the end-effector is introduced in order to consider also the velocity of the obstacles, improving the avoidance ability in dynamic environments. The algorithms previously tested for simplified planar cases are extended to a full mobility redundant manipulator operating in a spatial workspace. In addition to confirming the effectiveness of the control strategy, simulations give an estimation of the computational effort required to execute the algorithms, which is in line with typical requirements of robot controllers and can be improved by using higher performing hardware.
Future work will be directed on the one hand to improving the algorithms and on the other hand to transferring the control to a real system, now being installed. Some changes can be envisaged to the definition of the safety zone around obstacles/control points, which could be defined based on the relative speed between robot and obstacles, increasing for high speeds to ensure greater safety and vice versa to ensure greater mobility in case of static or quasi-static obstacles. Furthermore, the limitations imposed on the motor speeds could be exploited to estimate an overall parameter, such as the maximum speed allowed for obstacles, which can be used to verify a priori the ability to avoid an obstacle once its speed is perceived by the sensors of the system.

Author Contributions

Conceptualization, G.P. and C.S.; investigation, G.P. and C.S.; writing—original draft preparation, C.S.; writing—review and editing, G.P.; supervision, G.P. All authors have read and agreed to the published version of the manuscript.

Funding

This work is partly funded by the project URRA’ “usability of robots and reconfigurability of processes: enabling technologies and use cases”, on the topics of User-Centered Manufacturing and Industry 4.0, which is part of the project EU ERDF, POR MARCHE Region FESR 2014/2020–AXIS 1–Specific Objective 2–ACTION 2.1,“HD3Flab-Human Digital Flexible Factory of the Future Laboratory”, coordinated by the Polytechnic University of Marche.

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Conflicts of Interest

The authors declare no conflict of interest.

References

  1. Pedrocchi, N.; Vicentini, F.; Matteo, M.; Tosatti, L.M. Safe human–robot Cooperation in an Industrial Environment. Int. J. Adv. Robot. Syst. 2013, 10, 27. [Google Scholar] [CrossRef]
  2. Vicentini, F. Collaborative Robotics: A Survey. J. Mech. Des. 2020, 143, 040802. [Google Scholar] [CrossRef]
  3. Tang, S.H.; Kamil, F.; Khaksar, W.; Zulkifli, N.; Ahmad, S.A. Robotic motion planning in unknown dynamic environments: Existing approaches and challenges. In Proceedings of the 2015 IEEE International Symposium on Robotics and Intelligent Sensors (IRIS), Langkawi, Malaysia, 18–20 October 2015; pp. 288–294. [Google Scholar]
  4. Zlajpah, L.; Nemec, B. Kinematic control algorithms for on-line obstacle avoidance for redundant manipulators. In Proceedings of the IEEE/RSJ International Conference on Intelligent Robots and Systems, IEEE, Lausanne, Switzerland, 30 September–4 October 2002; pp. 1898–1903. [Google Scholar]
  5. Bottin, M.; Rosati, G. Trajectory Optimization of a Redundant Serial Robot Using Cartesian via Points and Kinematic Decoupling. Robotics 2019, 8, 101. [Google Scholar] [CrossRef] [Green Version]
  6. Gasparetto, A.; Boscariol, P.; Lanzutti, A.; Vidoni, R. Path planning and trajectory planning algorithms: A general overview. In Motion and Operation Planning of Robotic Systems; Springer: Berlin/Heidelberg, Germany, 2015; pp. 3–27. [Google Scholar]
  7. Han, B.; Luo, X.; Luo, Q.; Zhao, Y.; Lin, B. Research on Obstacle Avoidance Motion Planning Technology of 6-DOF Manipulator. In International Conference on Geometry and Graphics; Springer: Berlin/Heidelberg, Germany, 2021; pp. 604–614. [Google Scholar]
  8. Wang, J.; Liu, S.; Zhang, B.; Yu, C. Manipulation Planning with Soft Constraints by Randomized Exploration of the Composite Configuration Space. Int. J. Control. Autom. Syst. 2021, 19, 1340–1351. [Google Scholar] [CrossRef]
  9. Willms, A.R.; Yang, S.X. Real-time robot path planning via a distance-propagating dynamic system with obstacle clearance. IEEE Trans. Syst. Man, Cybern. Part B 2008, 38, 884–893. [Google Scholar] [CrossRef] [Green Version]
  10. Jung, J.H.; Kim, D.H. Local Path Planning of a Mobile Robot Using a Novel Grid-Based Potential Method. Int. J. Fuzzy Log. Intell. Syst. 2020, 20, 26–34. [Google Scholar] [CrossRef]
  11. Xu, P.; Wang, N.; Dai, S.L.; Zuo, L. Motion Planning for Mobile Robot with Modified BIT* and MPC. Appl. Sci. 2021, 11, 426. [Google Scholar] [CrossRef]
  12. Xu, X.; Hu, Y.; Zhai, J.; Li, L.; Guo, P. A novel non-collision trajectory planning algorithm based on velocity potential field for robotic manipulator. Int. J. Adv. Robot. Syst. 2018, 15, 1729881418787075. [Google Scholar] [CrossRef] [Green Version]
  13. Lee, K.; Choi, D.; Kim, D. Potential Fields-Aided Motion Planning for Quadcopters in Three-Dimensional Dynamic Environments. In Proceedings of the AIAA Scitech 2021 Forum, 11–15 January 2021; p. 1410. [Google Scholar]
  14. Abhishek, T.S.; Schilberg, D.; Doss, A.S.A. Obstacle Avoidance Algorithms: A Review. IOP Conf. Series: Mater. Sci. Eng. 2021, 1012, 012052. [Google Scholar] [CrossRef]
  15. Scoccia, C.; Palmieri, G.; Palpacelli, M.C.; Callegari, M. A Collision Avoidance Strategy for Redundant Manipulators in Dynamically Variable Environments: On-Line Perturbations of Off-Line Generated Trajectories. Machines 2021, 9, 30. [Google Scholar] [CrossRef]
  16. Chen, L.; Qin, D.; Xu, X.; Cai, Y.; Xie, J. A path and velocity planning method for lane changing collision avoidance of intelligent vehicle based on cubic 3-D Bezier curve. Adv. Eng. Softw. 2019, 132, 65–73. [Google Scholar] [CrossRef]
  17. Kawabata, K.; Ma, L.; Xue, J.; Zhu, C.; Zheng, N. A path generation for automated vehicle based on Bezier curve and via-points. Robot. Auton. Syst. 2015, 74, 243–252. [Google Scholar] [CrossRef]
  18. Yu, X.; Zhu, W.; Xu, L. Real-time Motion Planning and Trajectory Tracking in Complex Environments based on Bézier Curves and Nonlinear MPC Controller. In Proceedings of the 2020 Chinese Control And Decision Conference (CCDC), IEEE, Hefei, China, 22–24 August 2020; pp. 1540–1546. [Google Scholar]
  19. Corinaldi, D.; Carbonari, L.; Callegari, M. Optimal Motion Planning for Fast Pointing Tasks With Spherical Parallel Manipulators. IEEE Robot. Autom. Lett. 2018, 3, 735–741. [Google Scholar] [CrossRef]
  20. Corinaldi, D.; Callegari, M.; Angeles, J. Singularity-free path-planning of dexterous pointing tasks for a class of spherical parallel mechanisms. Mech. Mach. Theory 2018, 128, 47–57. [Google Scholar] [CrossRef]
  21. Maciejewski, A.A.; Klein, C.A. Obstacle avoidance for kinematically redundant manipulators in dynamically varying environments. Int. J. Robot. Res. 1985, 4, 109–117. [Google Scholar] [CrossRef] [Green Version]
  22. Scimmi, L.S.; Melchiorre, M.; Troise, M.; Mauro, S.; Pastorelli, S. A Practical and Effective Layout for a Safe human–robot Collaborative Assembly Task. Appl. Sci. 2021, 11, 1763. [Google Scholar] [CrossRef]
  23. Wang, W.; Zhu, M.; Wang, X.; He, S.; He, J.; Xu, Z. An improved artificial potential field method of trajectory planning and obstacle avoidance for redundant manipulators. Int. J. Adv. Robot. Syst. 2018, 15. [Google Scholar] [CrossRef] [Green Version]
  24. Safeea, M.; Béarée, R.; Neto, P. Collision Avoidance of Redundant Robotic Manipulators Using Newton’s Method. J. Intell. Robot. Syst. 2020, 99, 673–681. [Google Scholar] [CrossRef] [Green Version]
  25. Safeea, M.; Neto, P.; Bearee, R. On-line collision avoidance for collaborative robot manipulators by adjusting off-line generated paths: An industrial use case. Robot. Auton. Syst. 2019, 119, 278–288. [Google Scholar] [CrossRef] [Green Version]
  26. Zhang, H.; Jin, H.; Liu, Z.; Liu, Y.; Zhu, Y.; Zhao, J. Real-time kinematic control for redundant manipulators in a time-varying environment: Multiple-dynamic obstacle avoidance and fast tracking of a moving object. IEEE Trans. Ind. Inform. 2019, 16, 28–41. [Google Scholar] [CrossRef]
  27. Scoccia, C.; Palmieri, G.; Palpacelli, M.C.; Callegari, M. Real-Time Strategy for Obstacle Avoidance in Redundant Manipulators. In Proceedings of the International Conference of IFToMM ITALY; Springer: Berlin/Heidelberg, Germany, 2020; pp. 278–285. [Google Scholar]
  28. Khatib, O. Real-Time Obstacle Avoidance for Manipulators and Mobile Robots. Int. J. Robot. Res. 1986, 5, 90–98. [Google Scholar] [CrossRef]
  29. Chiaverini, S.; Siciliano, B.; Egeland, O. Review of the damped least-squares inverse kinematics with experiments on an industrial robot manipulator. IEEE Trans. Control Syst. Technol. 1994, 2, 123–134. [Google Scholar] [CrossRef] [Green Version]
  30. Melchiorre, M.; Scimmi, L.S.; Pastorelli, S.P.; Mauro, S. Collison Avoidance using Point Cloud Data Fusion from Multiple Depth Sensors: A Practical Approach. In Proceedings of the 23rd International Conference on Mechatronics Technology (ICMT), IEEE, Salerno, Italy, 23–26 October 2019; pp. 1–6. [Google Scholar]
  31. Cefalo, M.; Magrini, E.; Oriolo, G. Sensor-based task-constrained motion planning using model predictive control. IFAC-PapersOnLine 2018, 51, 220–225. [Google Scholar] [CrossRef]
  32. Lee, K.K.; Buss, M. Obstacle avoidance for redundant robots using Jacobian transpose method. In Proceedings of the IEEE/RSJ International Conference on Intelligent Robots and Systems, IEEE, San Diego, CA, USA, 29 October–2 November 2007; pp. 3509–3514. [Google Scholar]
Figure 1. Potential fields for trajectory planning.
Figure 1. Potential fields for trajectory planning.
Machines 09 00121 g001
Figure 2. Example of path planning in 3D space with two obstacles.
Figure 2. Example of path planning in 3D space with two obstacles.
Machines 09 00121 g002
Figure 3. Comparison between position and velocity profiles of potential fields trajectory and smoothed trajectory related to the example of Figure 2.
Figure 3. Comparison between position and velocity profiles of potential fields trajectory and smoothed trajectory related to the example of Figure 2.
Machines 09 00121 g003
Figure 4. (a) Alignment condition between end-effector, obstacle and goal in a simplified 2D representation; (b) example of trajectories generated by different directions of v d e v in the 3D space.
Figure 4. (a) Alignment condition between end-effector, obstacle and goal in a simplified 2D representation; (b) example of trajectories generated by different directions of v d e v in the 3D space.
Machines 09 00121 g004
Figure 5. Kinematic chain (top) and control points (bottom) for the KUKA LBR iiwa robot.
Figure 5. Kinematic chain (top) and control points (bottom) for the KUKA LBR iiwa robot.
Machines 09 00121 g005
Figure 6. Linear velocity of the end-effector E and of the control point P r closest to the obstacle P o .
Figure 6. Linear velocity of the end-effector E and of the control point P r closest to the obstacle P o .
Machines 09 00121 g006
Figure 7. Weighting coefficients a v and a h as functions of the distance d o .
Figure 7. Weighting coefficients a v and a h as functions of the distance d o .
Machines 09 00121 g007
Figure 8. Modified repulsive velocity.
Figure 8. Modified repulsive velocity.
Machines 09 00121 g008
Figure 9. Example 1: avoidance of a dynamic obstacle interfering with the end-effector in a fixed position.
Figure 9. Example 1: avoidance of a dynamic obstacle interfering with the end-effector in a fixed position.
Machines 09 00121 g009
Figure 10. Example 1: minimum distance robot-obstacle for the motion shown in Figure 9.
Figure 10. Example 1: minimum distance robot-obstacle for the motion shown in Figure 9.
Machines 09 00121 g010
Figure 11. Example 1: joint rotations and speeds for the motion shown in Figure 9.
Figure 11. Example 1: joint rotations and speeds for the motion shown in Figure 9.
Machines 09 00121 g011
Figure 12. Example 2: avoidance of a dynamic obstacle interfering with an internal point of the manipulator.
Figure 12. Example 2: avoidance of a dynamic obstacle interfering with an internal point of the manipulator.
Machines 09 00121 g012
Figure 13. Example 2: minimum distance robot-obstacle for the motion shown in Figure 12.
Figure 13. Example 2: minimum distance robot-obstacle for the motion shown in Figure 12.
Machines 09 00121 g013
Figure 14. Example 2: joint rotations and speeds for the motion shown in Figure 12.
Figure 14. Example 2: joint rotations and speeds for the motion shown in Figure 12.
Machines 09 00121 g014
Figure 15. Example 3: avoidance of two obstacles.
Figure 15. Example 3: avoidance of two obstacles.
Machines 09 00121 g015
Figure 16. Example 3: minimum distance robot-obstacle for the motion shown in Figure 15.
Figure 16. Example 3: minimum distance robot-obstacle for the motion shown in Figure 15.
Machines 09 00121 g016
Figure 17. Example 3: joint rotations and speeds for the motion shown in Figure 15.
Figure 17. Example 3: joint rotations and speeds for the motion shown in Figure 15.
Machines 09 00121 g017
Figure 18. Example 4: comparison between different methods for path generation; (a) Potential Fields, (b) Potential Fields with 3rd order Bézier Interpolation, (c) Potential Fields with 4th order Bézier Interpolation.
Figure 18. Example 4: comparison between different methods for path generation; (a) Potential Fields, (b) Potential Fields with 3rd order Bézier Interpolation, (c) Potential Fields with 4th order Bézier Interpolation.
Machines 09 00121 g018
Figure 19. Example 5: response of the control law to a moving obstacle with different values of k v .
Figure 19. Example 5: response of the control law to a moving obstacle with different values of k v .
Machines 09 00121 g019
Table 1. Parameters values used for simulations.
Table 1. Parameters values used for simulations.
r [ m ] r m [ m ] r min [ m ] v rep [ m / s ] v att [ m / s ] T [ s ]
0.180.150.121012
d t [ s ] k e k v λ m a x ϵ θ ˙ m a x [ rad / s ]
10 3 100100 10 3 10 3 π
Table 2. Results from simulations of Example 4.
Table 2. Results from simulations of Example 4.
T [ s ] L [ mm ] | | q ˙ | | max [ rad / s ] | | q ¨ | | max [ rad / s 2 ] Avg. Comp. Time [ms]
PF2850 2.23 134.03 54
PF+3BI2824(−3.1%)2.16(−3.1%)12.61(−90.6%)60(+11.1%)
PF+4BI2829(−2.5%)2.15(−3.6%)13.26(−90.1%)62(+14.8%)
Table 3. Results from simulations of Example 5.
Table 3. Results from simulations of Example 5.
T [ s ] L [ mm ] | | q ˙ | | max [ rad / s ] | | q ¨ | | max [ rad / s 2 ] Avg. Comp. TimeCollision
(1 Cycle) [ms]Avoided
k v = 0 2747 14.87 402.55 0.86 No
k v = 100 2725(−2.9%)11.89(−20.0%)273.16(−32.1%)0.85(−1.2%)Yes
k v = 500 2710(−-5.0%)7.54(−49.3%)79.23(−80.3%)0.87(+1.2%)Yes
k v = 1000 2724(−3.1%)6.48(−56.4%)187.05(−53.5%)0.90(+4.7%)Yes
Publisher’s Note: MDPI stays neutral with regard to jurisdictional claims in published maps and institutional affiliations.

Share and Cite

MDPI and ACS Style

Palmieri, G.; Scoccia, C. Motion Planning and Control of Redundant Manipulators for Dynamical Obstacle Avoidance. Machines 2021, 9, 121. https://doi.org/10.3390/machines9060121

AMA Style

Palmieri G, Scoccia C. Motion Planning and Control of Redundant Manipulators for Dynamical Obstacle Avoidance. Machines. 2021; 9(6):121. https://doi.org/10.3390/machines9060121

Chicago/Turabian Style

Palmieri, Giacomo, and Cecilia Scoccia. 2021. "Motion Planning and Control of Redundant Manipulators for Dynamical Obstacle Avoidance" Machines 9, no. 6: 121. https://doi.org/10.3390/machines9060121

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