arXiv:0905.0749v1 [cs.RO] 6 May 2009 Soft Motion Trajectory Planner for Service Manipulator Robot Xavier Broqu`ere∗ Daniel Sidobre∗ Ignacio Herrera-Aguilar∗‡ ∗LAAS - CNRS and Universit´e de Toulouse 7, avenue du Colonel Roche 31077 Toulouse, France lastname@laas.fr ‡Instituto Tecnologico de Orizaba Av. Oriente 9 No.852 94330 Orizaba, Mexico Abstract Human interaction introduces two main constraints: Safety and Comfort. Therefore service robot manipulator can’t be controlled like industrial robotic manipulator where person- nel is isolated from the robot’s work envelope. In this paper, we present a soft motion trajectory planner to try to ensure that these constraints are satisfied. This planner can be used on-line to establish visual and force control loop suit- able in presence of human. The cubic trajectories build by this planner are good candidates as output of a manipula- tion task planner. The obtained system is then homogeneous from task planning to robot control. The soft motion trajectory planner limits jerk, accelera- tion and velocity in cartesian space using quaternion. Ex- perimental results carried out on a Mitsubishi PA10-6CE arm are presented. 1 INTRODUCTION Arm manipulator control for industrial applications has now reached a good level of maturity. Many solutions have been proposed for specific utilizations. However, all these appli- cations are confined to structured and safe spaces where no human-robot interactions occur. Arm manipulators for human interaction need to be in- trinsically safe [1] [2], but the control level has also to guar- antee safety and comfort for humans. The soft motion tra- jectory planner presented in this paper provides tools to build such systems by limiting jerk, acceleration and veloc- ity. The problem of robot control has been divided in two hier- archical levels; the lower level called control or path tracking and the upper level called trajectory planning. Using this ap- proach, industrial robots can evolve at high speeds satisfying path constraints. Literature presents various works, Geering and al [3] propose time-optimal motions using a bang-bang control, Rajan proposes a two steps minimization algorithm [4], temporal/torque constraints are considered in the works of Shin and McKay [5], Bobrow and al [6] and finally Kyri- akopoulos and Saridis propose minimal jerk control [7]. The objectives of the trajectory planner are to improve tracking accuracy and reduce manipulator wear by providing contin- uous references to the servo-motors control. Needs for pro- ductivity improvements for numerically controlled machine tools have generated numerous work to optimize feed-rate. In this case path tracking accuracy is far more important and approaches become similar. For example J. Dong [8] shows that limiting jerk in feed-rate optimization leads up a decrease of contouring errors and acoustic signals. In a human interaction context, safety is directly linked with the velocity limit and comfort with acceleration and jerk bounds. Such constrained movements are soft in carte- sian space even for rotations, starts and stops. This planner is used daily to plan trajectory along a path computed by HAMP [9], a Human Aware Motion Planner, and Grasp Planner [10], both using Move3D [11]. These paths are de- fined by lines that connect different points. The tempo- ral evolution along the path is then computed by the soft motion trajectory planner as presented in the experimental section. Beside the limitations in jerk, acceleration and ve- locity provided by this approach, we hope that this would help to integrate visual and force loop that are known to have different time constant. This paper presents the related work in section II. Section III describes the soft motion trajectory planner and section IV presents some experimental results. 2 Related Work To achieve smooth motion and tracking in task or joint space, several approaches have been presented, such as trapezoidal or bell-shaped velocity profiles using cubic, quar- tic or quintic polynomials. Lloyd [12] introduces a method adjusting the spatial shape of the transition curve of adja- cent path segments. Liu [13] uses seven cubics to update on-line a smooth mono-dimensional motion. Andersson [14] uses a single quintic polynomial for repre- senting the entire trajectory, while Macfarlane [15] extends Andersson’s work and uses seven quintic polynomials for in- dustrial robots. In the case of human interaction Amirabdollahian and al [16] use a seventh order polynomial while Seki and Tadakuma [17] propose the use of fifth order polynomial, both of them for the entire trajectory with a minimum jerk model. Herrera and Sidobre [18] propose seven cubic equa- tions to obtain Soft Motions for robot service applications. 3 Soft Motion Trajectory Planner We consider the planning of a trajectory defined by a set of points generated by path planning techniques that the end- effector must follow in cartesian space. We propose a soft motion trajectory planner that limits jerk, acceleration and velocity for service robot applications. 3.1 Monodimensional Case In order to better understand elementary motions, we introduce the acceleration-velocity frame (Fig. 1). Then we consider the point to point canonical case of Fig. 2. Finally, we extend our approach to general cases in which initial and final kinematic conditions are not null. 3.1.1 The elementary motions in the Acceleration- Velocity frame Initial and final conditions are defined by: A(T0) = A0 A(Tf) = Af V (T0) = V0 V (Tf) = Vf (1) X(T0) = X0 X(Tf) = Xf In order to simplify the presentation, we choose : Jmin = −Jmax Amin = −Amax Vmin = −Vmax Curves J(t), A(t), V (t), X(t) respectively represent jerk, acceleration, velocity and position functions. In the Fig. 1, the point A corresponds to the state in which motion is stopped. Upper line JC and lower line EH respectively de- fine maximal (Amax) and minimal (−Amax) accelerations. The system can stay endlessly on a point along the IAD axis because of null acceleration. The velocity of motion is maximal (Vmax) on the point D and minimal (−Vmax) on I. The other states are unstable states, like for example from the point C, the only possible evolution is to join the point D. The CDE parabolic curve represents an evolution Figure 1: Acceleration-Velocity frame at maximal jerk Jmax. The HIJ curve, in contrast, repre- sents minimal jerk evolution (−Jmax). The acceleration axis becomes a symmetric axis of the two maximal and minimal jerk parabolas (eq. 2 & 3). V (t) = V0 + 1 2.Jmax A(t)2 (2) V (t) = V0 − 1 2.Jmax A(t)2 (3) where V0 ∈[−Vmax, Vmax] is the velocity at A(t) = 0 The optimal motion is a motion with jerk, acceleration and velocity constraints successively saturated [18]. Then, we can define three elementary motions (Ai, Vi and Xi are initial conditions of segments) : • The motion with a saturated jerk ±Jmax (AB, CD, DE, FA, AG, HI, IJ and KA segments): J(t) = ±Jmax A(t) = Ai ± Jmaxt V (t) = Vi + Ait ± 1 2Jmaxt2 X(t) = Xi + Vit + 1 2Ait2 ± 1 6Jmaxt3 • The motion with a saturated acceleration ±Amax (BC, EF, GH and JK segments): J(t) = 0 A(t) = ±Amax V (t) = Vi ± Amaxt X(t) = Xi + Vit ± 1 2Amaxt2 • Finally, the motion with a saturated velocity ±Vmax (D and I segments): J(t) = 0 A(t) = 0 V (t) = ±Vmax X(t) = Xi ± Vmaxt 3.1.2 The point to point motion In this case, initial and final conditions are defined by: A(T0) = 0 A(Tf) = 0 V (T0) = 0 V (Tf) = 0 X(T0) = 0 X(Tf) = Xf Figure 2: Jerk, Acceleration, Speed and Position curves and Motion in the Acceleration-Velocity Frame Fig. 2 represents the optimal motion which can be separated in seven segments: Tjpa = T1 −T0 Jerk positive time Taca = T2 −T1 Acceleration constant time Tjna = T3 −T2 Jerk negative time Tvc = T4 −T3 Velocity constant time Tjnb = T5 −T4 Jerk negative time Tacb = T6 −T5 Acceleration constant time Tjpb = Tf −T6 Jerk positive time Because of the point to point motion, it appears an anti- symmetry in acceleration and a symmetry in jerk with re- spect to the Tvc segment. Concerning the velocity curve, the symmetry effect is also present. We have then: Tj = Tjpa = Tjna = Tjnb = Tjpb Ta = Taca = Tacb Tv = Tvc Our system computes times Tj, Ta and Tv to get the desired soft displacement between an origin position and a final po- sition. As the end effector moves under maximum motion conditions (Jmax, Amax or Vmax), we obtain a minimal time motion. However, optimal motion has seven elementary mo- tions at most as demonstrated below : i) We consider a motion composed of a constant velocity motion at Vmax, which occurs during a period dt1, and also of a constant velocity motion at −Vmax during dt2 ≥dt1. The motion at Vmax balances the motion at −Vmax. So, it’s possible to find a motion with a shorter time which sat- isfies initial and final conditions. In other words, in the acceleration-velocity frame, a motion can’t stay on both the D and I points. ii) If a motion has a constant unsaturated velocity segment, it’s also possible to find a motion with a saturated velocity segment or without a constant velocity segment at all. In both cases, the motion time is shorter. Thus, optimal mo- tions can’t have an unsaturated constant velocity segment. iii) If motion doesn’t reach neither the D nor I points, parabolic curves can only be at the beginning or at end of motion. Therefore, optimal motions can’t have more than seven ele- mentary motions. 3.1.3 Types of motions As optimal motion is a Soft motion in minimal time, states with constant velocities can only be at the D and I points. So, in order to attain some initial and final conditions, there are two type of motions. A motion starting with a maxi- mum jerk segment will be called type 1 motion and a motion starting with a minimum jerk segment, type 2 motion. For example, Fig. 3 illustrates type 1 motion which joins the point D. Fig. 4 illustrates type 2 motion which joins the point I. For short displacement, optimal motion doesn’t have the constant velocity segment. However, we have to focus on a particular motion which we call Critical motion defined by a critical length dc. 3.1.4 The critical length Fig. 5 presents critical motion that separates motion type 1 (Fig. 3) from motion type 2 (Fig. 4). Critical length is the distance D = Xf −X0 done when the time motion is minimal and separates continiously motion type 1 and motion type 2. When the distance to cross becomes larger than dc, motion is a type 1 motion. On the other hand, when the length becomes smaller than dc, motion is a type 2 motion. 3.1.5 The general case The previous canonical case (3.1.2) produces simple equa- tions because of the symmetry of curves. When initial and final kinematic conditions are no longer null, there is no more symmetry. However, it’s important to observe that there is an impair symmetry between type 1 motion and type 2 mo- tion in the acceleration velocity frame. With this property, we can compute a type 2 motion as a type 1 motion and thus we can divide the number of algorithm’s functions by two. We have developed an algorithm which computes the time of the seven segments for type 1 motions. Because of its size, we will not detail it in this paper. Inputs are ini- tial and final conditions (eq. 1) and the Jmax, Amax and Vmax constraints. This algorithm is based on thresholds that define particular lists of elementary motions. The most Figure 3: Motion type 1 with V max reached Figure 4: Motion type 2 with −V max reached Figure 5: Motion type hybrid: Critical Motion complicated cases correspond to the resolution of a six de- gree equation. This equation represents the intersection of three parabolic curves. 3.2 Multidimensional Case We present two interesting cases of the multidimensional extension: • The point to point motion: initial and final kinematic conditions are null. • The path following motion: the system has to pass over some points. 3.2.1 The point to point motion Motion, in a n dimensional space between two points, is a straight-line path. The only way to ensure straight-line path is that motions have the same duration along each dimension. To do that, we compute the final time for each dimension. Considering the largest motion time, we readjust the other dimension motions to this time. Time adjusting is done by decreasing linearly Jmax, Amax and Vmax. In other words, the motion is minimum time for one direction. In the other directions, the motions are conditioned by the minimum one. 3.2.2 The path following motion We consider a trajectory defined by points in the cartesian space (Fig. 6). At least three points are necessary: the current position of the end-effector (P0), the first target po- sition (P1) and the final position (Pf). We describe the planification for a three points motion: Step 1: We compute the adjusted point to point motion (3.2.1) between the current position (P0) and the interme- diate point (P1). We compute also the adjusted point to point motion between the point (P1) and the final point (Pf). In this state, the motion is stopped at (P1). Step 2: We use the algorithm described in 3.1.5 for each axis. For this transition motion, we use as initial conditions the ones found at the end point of the Tvc segment of the first point to point motion (ICT ) (Fig. 6) and as final con- ditions the states at the beginning of the Tvc segment of the second point to point motion (FCT ). So we have for each axis : A(ICT ) = 0 A(FCT ) = 0 V (ICT ) = V0 V (FCT ) = Vf X(ICT ) = X0 X(FCT ) = Xf Step 3: Once the algorithm 3.1.5 is carried out, we have the optimal times Topt for each axis. Then, we have to constrain the motion time duration of each axis considering the axis which has the largest duration. We call this particular time Timp. For this transition motion, we can have various type of motions like start motion, stop motion and an infin- ity of combinations for V0 and Vf velocities varying in the [−Vmax, Vmax] interval. The length D = Xf −X0 is condi- tioned by V0 and Vf. Thus, this length is a particular one because we have computed the point to point motions at the beginning. It represents the distance done when the motion is linking V0 and Vf passing over the point A (Fig. 1). So, adjusting time duration of the transition trajectory is more difficult than the adjustment of the point to point motion. However, we have a particular time Tstop, the time needed to stop and restart the motion passing through (P1). If the imposed time Timp is larger than Tstop, we can stop the motion and adjust the duration by adding time when the motion is stopped. In the other cases when Timp is between Topt and Tstop, we have to find a combination of seven cubic segments satisfying initial and final conditions and the kinematic constraints. Now we are breaking down different ways to adjust the duration of axis transition motions. Soft transition motions must be under kinematic con- straints, so we can’t increase Jmax, Amax and Vmax. Because of real time constraint, we don’t want to solve our problem by using random or optimization algorithms. In 3.2.1, we adjust duration by decreasing limit conditions (Jmax, Amax and Vmax). This strategy doesn’t work anymore. Indeed, we can’t decrease Vmax in a motion if initial and final velocities are Vmax. In this case, motion is only composed of a satu- rated velocity segment and decreasing Jmax or Amax doesn’t change the duration of the motion. When initial and final velocities are smaller than Vmax, decreasing Jmax andAmax increase the critical length. In this way, when critical length reaches and runs over D, the type of motion changes and a time interval without solution appears. So, we can’t adjust motions like in 3.2.1. Another solution is to find a seven cubic segments with a constant velocity Vc for the Tvc segment slower than Vmax which we call Slowing Velocity Motion. This motion isn’t an optimal motion yet. However, there are intervals with no solution if the duration of the motion vary between Topt and Tstop. Indeed, in the cases of V0 and Vf are near Vmax, it’s possible to don’t have enough time to join the low velocity needed to do the distance D in a time Timp. The problem is that segments with saturated jerk last too long. Note that it’s possible to minimize this problem by taking a jerk Jadj Figure 6: Planning of a motion with three points bigger than Jmax in order to decrease time of jerk saturated intervals. However, increase jerk is not a good solution be- cause motion run over kinematic constraints. For each axis, we compute intervals between Topt and Tstop where a solution exists by computing Slowing Velocity Mo- tion. Then the imposed time Timp is the minimal time when there is a solution for each axis. An example illustrates this method in the Experimental Results part (4.3). 4 Experimental Results 4.1 Experimental Platform We implemented the soft motion trajectory planner on Jido (Fig. 7), a mobile Neobotix platform MP-L655 with top mounted manipulator PA10 from Mitsubishi. The software control is developed using Open Robots tools: GenoM [19]. The sampling time is fixed to 10 ms. The linear and angular end-effector motions are limited by: Linear limits Angular limits Jmax 0.900m/s3 0.600rad/s3 Amax 0.300m/s2 0.200rad/s2 Vmax 0.150m/s 0.100rad/s The Pose of the manipulator’s end effector is defined by seven independent coordinates said Operational Coor- dinates. They give the position and the orientation of the final body in the reference frame. The advantages of using quaternions are largely exposed in [20]. We define P for the position and Q for the orientation P = x y zT Q = n qT where q = i j kT The linear obtained velocities V can be directly applied as velocity references. On another hand, the evolution of the quaternion ˙Q must be transformed into angular velocities. We use the transformation function proposed in [21]. Ω 0  = 2Q⊤ r ˙Q where Qr =   n k −j i −k n i j j −i n k −i −j −k n   Figure 7: Our robot Jido composed of a mobile base and a 6 dof arm Figure 8: Soft motion of the end-effector (only X axis) 4.2 On-line trajectory planning without time adjustment A 6 axis joystick (4 analog axis and 2 digital) gives velocity references (VRef) which must be followed by the end-effector. VRef =  vx vy vz ωx ωy ωz T To track these velocities, we use the trajectory planner (3.1.5) on-line. Translation motions are independently computed. However, we have to compute the quaternion derivative ˙Q for angular motions. As the sampling time is 10 ms, we consider that angular variation is small. So, we can use the current quaternion Q as the final one to compute ˙Q: ˙Q = 1 2QΩ with Ω= ωx ωy ωzT Then, we have the vector VRefP ose: VRefP ose =  vx vy vz ˙Q T Trajectory is planned every 10 ms : initial conditions are the current state and final conditions are acceleration null and velocities VRefP ose. For each direction, the distance to go D = Xf −X0 is the critical length for initial and final con- ditions. This particular length defines the shortest motion to attain final conditions. Other lengths would introduce oscillations because motion will not directly join final con- ditions. Fig. 8 illustrates the end-effector evolution for X axis. 4.3 Tracking trajectory motion Even though we can do rotation, for the clarity of the pre- sentation, we present a translation motion. We consider the trajectory defined by the three points : P0 =   X(P0) = X0 Y (P0) = Y0 Z(P0) = Z0   P1 =   X(P1) = X0 + 0.15 Y (P1) = Y0 + 0.15 Z(P1) = Z0   Pf =   X(Pf) = X(P1) + 0.15 Y (Pf) = Y (P1) + 0.15 Z(Pf) = Z(P1) + 0.15   Figure 9: Time intervals where Slowing Velocity Motion works (0 : without solution ; 1 : with solution) Considering steps and notation explained on 3.2.2, we com- pute the point to point motions between P0 and P1 and between P1 and Pf. So, the initial and final conditions for the transition motion are : Axis X Axis Y Axis Z V(ICT ) (m/s) 0.150 0.150 0 V(FCT ) (m/s) 0.150 0.150 0.15 D (m) 0.125 0.125 0.0623 Topt (s) 0.833 0.833 0.84 where D is the axis displacement. At this step, we have to adjust transition motion times. So, as explained in 3.2.2, we compute time intervals when Slowing Velocity Motion works. Fig. 9 illustrates how to find Timp . More video results could be found at: http://www.laas.fr/∼xbroquer 5 Conclusions The soft motion trajectory planner presented in this paper is simpler than previous ones and avoids the optimization stage. For both the point to point motion and the transition motion, series of cubic curves are computed. For each axis, these cubic trajectories share the same time intervals. Due to direct computation of cubic parameters, the planner is fast enough to be used on-line. Experimental results show the validity of the approach for real-time control and trajectory planning in human pres- ence. To improve task planner characteristics, we are cur- rently incorporating the trajectory planner into the path planner. Our objective is to directly build soft cubic curves at the task planification level and enjoy richer families of curves. 6 Acknowledgments The research leading to these results has received funding from the European Communitys Seventh Framework Pro- gramme (FP7/2007-2013) under grant agreement n 216239 with DEXMART project. References [1] A. Bicchi and G. Tonietti, “Dealing with the safety- performance trade-offin robot arms design and con- trol,” IEEE Robotics and Automation Magazine, vol. (in press), 2004. [2] I. european project PHRIENDS, http://www.phriends.eu/. [3] L. G. S. A. H. Hans P. Geering and C. H. Onder, “Time-optimal motions of robots in assembly tasks,” IEEE Transactions on Automatic Control, vol. AC-31, pp. 512–518, June 1986. [4] V. T. Rajan, “Minimum time trajectory planning,” in ICRA, vol. 2, Mars 1985, pp. 759–764. [5] K. G. Shin and N. D. McKay, “Minimum-time con- trol of robotic manipulatos with geometric path con- straints,” IEEE Transactions on Automatic Control, vol. AC-30, pp. 531–541, June 1985. [6] S. D. J. E. Bobrow and J. S. Gibson, “Time optimal control of robotic manipulators along specified paths,” Int. J. Robotic Research, vol. 4, pp. 3–17, 1985. [7] K. J. Kyriakopoulos and G. N. Saridis, “Minimum jerk path generation,” in Proc. IEEE International Confer- ence on Robotics and Automation, 1988, pp. 364–369. [8] P. F. Jingyan Dong and J. Stori, “Feed-rate optimiza- tion with jerk constraints for generating minimum-time trajectories,” International Journal of Machine Tools and Manufacture, 2007. [9] E. A. Sisbot, L. F. Marin, and A. Rachid, “Spatial reasoning for human robot interaction,” in IROS, San Diego, USA, 2007. [10] E. Lopez-Damian, D. Sidobre, and R. Alami, “A grasp planner based on inertial properties,” in Proc. IEEE International Conference on Robotics and Automation, Barcelona, Spain, April 2005, pp. 766–771. [11] T. Sim´eon, J.-P. Laumond, and F. Lamiraux, “Move3d: a generic platform for motion planning,” in 4th Inter- national Symposium on Assembly and Task Planning, Japan, 2001. [12] J. Lloyd and V. Hayward, “Trajectory generation for sensor-driven and time-varying tasks,” International Journal Robotics Research, vol. 12, pp. 380–393, Au- gust 1993. [13] S. Liu, “An on-line reference-trajectory generator for smooth motion of impulse-controlled industrial manip- ulators,” in 7th International Workshop on Advanced Motion Control, 2002, pp. 365–370. [14] R. L. Andersson, “Aggressive trajectory generator for a robot ping-pong player,” IEEE Control Systems Mag- azine, vol. 9, pp. 15–20, February 1989. [15] S. Macfarlane and E. Croft, “Jerk-bounded manipula- tor trajectory planning: Design for real-time applica- tions,” IEEE Transactions on Robotics and Automa- tion, vol. 19, pp. 42–52, February 2003. [16] R. L. Farshid Amirabdollahian and W. Harwin, “Mini- mum jerk trajectory control for rehabilitation and hap- tic applications,” in ICRA, May, 2002, pp. 3380–3385. [17] K. Seki and S. Tadakuma, “Minimum jerk control of power assiting robot based on human arm behavior characteristic,” in International Conference on Sys- tems, Man and Cybernetics, 2004, pp. 722–721. [18] I. Herrera and D. Sidobre, “On-line trajectory planning of robot manipulator’s end effector in cartesian space using quaternions,” in 15th Int. Symposium on Mea- surement and Control in Robotics, 2005. [19] S. Fleury, M. Herrb, and R. Chatila, “Genom: A tool for the specification and the implementation of oper- ating modules in a distributed robot architecture,” in IROS, vol. 2, Grenoble, France, Septembre 1997, pp. 842–848. [20] J. Funda, R. H. Taylor, and R. P. Paul, “On homo- geneous transforms, quaternions and computational ef- ficiency,” IEEE Trans. on Robotics and Automation, vol. 6, pp. 382–388, Juin 1991. [21] H. Bruyninckx and J. Shutter, “Introduction to in- telligent robotics,” Katholieke Universiteit de Leuven, Tech. Rep., 2001.