Sound and fast footstep planning for humanoid robots

Size: px
Start display at page:

Download "Sound and fast footstep planning for humanoid robots"

Transcription

1 Sound and fast footstep planning for humanoid robots Nicolas Perrin, Olivier Stasse, Léo Baudouin, Florent Lamiraux, Eiichi Yoshida Abstract In this paper we present some concepts for sound and fast footstep planning. The soundness is achieved with a two-stage trajectory generation process that uses a smoothing homotopy. The fastness is achieved with swept volume approximations precomputed offline. I. INTRODUCTION This paper is roughly a condensed version of [16], where methods and results are presented in more details. Footstep planning is the problem of generating walk motions for a humanoid robot that must go from an initial position to a goal in an environment with obstacles. In this paper we assume that the walking surface is flat and horizontal. Footstep planning is a key problem in the field of humanoid robotics, because one of the reasons for making humanoid robots is precisely that they should be able to move about in environments that are not accessible to wheeled robots. In the last decade, this problem has been studied extensively, and although no really satisfying solution exists so far, a lot of promising approaches have been experimentally validated (see [9], [4], [18], [5]). Because of its complexity, footstep planning is usually not solved directly. Indeed, it combines high dimensionality with underactuation and complex balance constraints, three issues that make it a difficult motion planning problem. On top of that, in order to be compatible with human behaviours, the robot is often required to quickly generate walking motions to go to a given goal. To make this problem simpler, the solution usually adopted is to first plan only a sequence of footprints, and then, using a walking pattern generator, produce a trajectory in the configuration space so that the robot will follow the footprints and avoid the obstacles without falling. The good thing about this strategy is that the problem of planning footprints is much easier to solve than the full footstep planning problem, and what is more there exist efficient algorithms to generate walking motions from sequences of footprints. But the risk with this separation is to produce footprint sequences that do not lead to feasible trajectories, or on the contrary be overconservative and frequently miss solutions. When the first issue is avoided we say that the separation is sound, and when solutions are not missed we say it is complete. Completeness, or at least almost completeness, is desirable, but soundness is Nicolas Perrin, Olivier Stasse, Léo Baudouin and Florent Lamiraux are with Université de Toulouse ; UPS, INSA, INP, ISAE ; CNRS ; LAAS ; F Toulouse, France (nperrin@laas.fr, ostasse@laas.fr, leo.baudouin@laas.fr, florent@laas.fr) Eiichi Yoshida is with CNRS-AIST JRL (Joint Robotics Laboratory), UMI3218/CRT AIST Central 2, Umezono 1-1-1, Tsukuba Japan (e.yoshida@aist.go.jp) crucial. In this paper we present an efficient solution that provides a sound separation and is not too overconservative. An example of overconservativeness we want to avoid is the one of the bounding box method (see [20]): we want to robot to be able to use its stepping-over capabilities to overcome small obstacles on the floor. Let us recall the principles of the bounding box method: first, a box (usually a rectangular cuboid) is defined that contains the whole robot. Then, using classical path planning techniques, a continuous collision-free path is found for the box, from an initial location to a goal. Then, footsteps are generated such that the robot stays at all time inside the volume swept by the box during its motion. This approach is clearly sound: if the robot stays inside the volume swept by the box, and if the path found for the box is collision-free, then a fortiori the robot motion is collision-free. However this approach is not complete, and if there is for example a cable around the robot on the floor, then it is impossible to find a collision-free motion of the box that would escape from the region defined by the cable. So, even if the robot could in fact step over the cable with ease, the bounding box method will never find a solution. An other example of overconservativeness occurs when the variety of steps considered by the planner is not representative of the actual stepping capabilities of the robot. Many state-of-the-art approaches based on the use of the algorithm A* on a small set of steps are threatened by this issue (see for example [8], [2], [3], [4], [6]). For the separation to be sound, a cautious analysis of the walking pattern generator is required. For example, with state-of-the-art walking pattern generators, the motion performed by the robot tend to depend not only on the current step, but also on the previous and next few steps (that is true in particular when preview control is used, see [7]), and that makes sound separations difficult to obtain. In Section II, we briefly present a two-stage walking pattern generator that uses a smoothing homotopy to enable the generation of stateof-the-art trajectories while keeping a sound separation. In Section III, we present experiments obtained on the robot HRP-2 with a footstep planning algorithm based on this walking pattern generator and on a finite but large set of steps for which swept volume approximations are precomputed offline. Section IV is the conclusion. II. A TWO-STAGE WALKING PATTERN GENERATOR BASED ON A SMOOTHING HOMOTOPY In this section we briefly present a walking pattern generator that combines half-steps for dimensionality reduction, and a smoothing homotopy. The dimensionality reduction

2 Fig. 1. The intermediate posture Q right used in [8] for transitioning between left leg footstep placements. brought by the use of half-steps is interesting for offline precomputations, as we will see in Section III, but in this section we focus on the smoothing homotopy which enables a sound separation between the (footprint) planning phase and the trajectory generation. For more details about this walking pattern generator, see [17], or [16]. The use of half-steps is a bit similar to the approach introduced in [8]: half-steps are obtained by introducing two statically stable, intermediate postures Q right and Q left that serve as via point configurations for all footstep transitions (see Fig. 1). Once these configurations are fixed, an isolated half-step (downward or upward) can be defined by three parameters only. The goal of our walking pattern generator is of course to take in input a sequence of footprints, and return in output a (discretized) trajectory in the configuration space of the robot. This is done with two distinct phases. During the first phase, an initial configuration space trajectory is given: it corresponds to a simple concatenation of isolated halfsteps. This concatenation is possible because each half-step starts and ends at zero speed in a balanced posture. With this simple concatenation it is easy to achieve soundness at the planning phase. Indeed, if the planner needs to verify the validity of random footsteps, it can simply use the trajectory corresponding to the concatenation of isolated half-steps: no matter what next and previous footsteps will eventually be decided, after the first phase the resulting trajectory will always correspond to this concatenation of half-steps. Thus, if the trajectory is verified and considered feasible by the planner, it will also be feasible inside the trajectory obtained after the first phase. This trajectory could be used to move the robot from its initial configuration to the goal, and the method would arguably be not too conservative. However, this result would not be satisfying for several reasons. First, between each half-step the robot would come to a stop, and the walk motion would not be visually smooth. Furthermore, because of these stops the motion would be rather slow, and not energy-efficient. Recent walking pattern generators using preview control (see [7]) achieve much better results. Next, we present the principles of a smoothing homotopy that continuously modifies the initial trajectory in order to make it smoother and faster. Because the modifications are continuous, it is easy to keep the soundness of the whole process. Indeed, we know that the sequence of footprints found by the planner corresponds to a feasible initial trajectory, and then we can continuously smooth it and stop just before it becomes unfeasible. The key principle of our smoothing homotopy is very similar to the one of the mixtures of motions introduced in ([14] and [15]), but in these papers the purpose was to create new steps, not to smooth them nor speed them up. To explain this principle, let us present first a few aspects of our trajectory generation process. We use a classical simplified model of the robot dynamics: the linear inverted pendulum model (see [7]). In this model the mass of the robot is assumed to be concentrated in its CoM (Center of Mass) which is supposed to be rigidly linked to the robot waist and directly above it at all time. Besides, the robot is supposed to have only coplanar point contacts with the horizontal walking surface. An analysis of the subsequent equations leads to a further approximation which enables the decoupling of the dynamic differential equations for the x-axis and y-axis. They can be written as follows: p x = Z(x) (1) p y = Z(y) (2) with Z Id z c g d dt 2 (3) (x, y) are the (x-axis,y-axis) coordinates of the CoM of the robot, z c is the height of the robot center of mass which is supposed constant during the steps, and (p x, p y ) are the (x-axis,y-axis) coordinates of the virtual Zero Moment Point (ZMP). A classical dynamic balance criterion for biped walking is that the ZMP should stay at all time inside the polygon of support (see [19]). An important thing to notice in these equations is that Z is a linear operator. Using these equations, we use the following strategy to generate halfstep trajectories: first, we define a trajectory for the swing foot. This trajectory depends on the 3 parameters defining the half-step. Then, we define a trajectory for the ZMP that also depends on the 3 parameters and that stays at all time inside the polygon of support. Finally, using the linear equations (1) and (1), we compute a corresponding horizontal trajectory for the CoM. All the half-step motions have the same duration T. With concatenations of these half-step motions we obtain initial trajectories, and we will explain how to continuously modify a sequence of half-steps in order to make it faster and smoother along the same footprint sequence. We first show how to do so for a sequence of two half-steps, and start with the case of an upward half-step followed by a downward half-step. 1) Upward then downward: We consider an upward halfstep followed by a downward half-step. The upward half-step is shown on Fig. 2 (we take as origin the center of the support foot). Together the two half-steps make a classical full step: double support phase, then quick ZMP shift and single support phase, and then second quick ZMP shift and double

3 x y z (0, 0, 0) Fig. 2. Representation of an upward half-step from above. support phase again. We denote by ( (x 1 (t), y 1 (t)) ) t [0,T ] the ( horizontal CoM trajectory for the first half-step, and by (x2 (t), y 2 (t)) ) the horizontal CoM trajectory for the t [0,T ] second half-step. We explain only the smoothing process for the component along the y-axis, but it is exactly the same process for component along the x-axis. At the end of the upward half-step, the robot is in a balanced posture, with its CoM directly above the center of the support foot. Thus, we have: y 1 (T ) = y 2 (0) = 0. Let us now define two operators g 1 and g2 such that: { g (f)(t) 1 f(t) for t (0, T ) = (4) f(t ) for t (T, 2T ) { g (f)(t) 2 0 for t (0, T ) = f(t T + ) f(0) for t (T, 2T ) (5) g0(y 1 1 ) + g0(y 2 2 ) corresponds to the simple concatenation of y 1 and y 2 without overlap. Knowing that p y1 = Z(y 1 ), p y2 = Z(y 2 ), and y 1 (T ) = y 2 (0) = 0, it is quite easy to verify that for any 0 T, g 1 (p y 1 ) = Z(g 1 (y 1)) and g 2 (p y 2 ) = Z(g 2 (y 2)). And, since Z is a linear operator: g 1 (p y1 ) + g 2 (p y2 ) = Z(g 1 (y 1 ) + g 2 (y 2 )) (6) It follows that operators g 1 and g2 enable us to obtain new combined CoM and ZMP trajectories that still verify the Linear Inverted Pendulum equations (eq. (1) and eq. (2)). Starting with = 0 and progressively increasing the value of continuously modifies the CoM trajectory (starting from the initial trajectory g0(y 1 1 ) + g0(y 2 2 )) to make the second ZMP shift (the one of p y2 ) happen earlier, creating an overlap of duration between the two trajectories y 1 and y 2. Fig. 3 illustrates this effect. When we increase the value of we can see for example that the position of the CoM does not need to reach the center of the support foot anymore. Fig. 3. Progressively increasing the overlap between two half-steps. We denote by SF y(0) the initial position of the swing foot along the y-axis. The plot on the top shows the trajectories y(t) and p y(t) for a raw sequence of two half-steps (no overlap), the first half-step being the one of Fig. 2. Notice that the CoM reaches the ZMP between the half-steps. On the other plots, we show the effect of progressively increasing the overlap, using the operators g 1 and g2. We can see that the CoM trajectory becomes more natural: it does not need to reach the top of the ZMP curve between the two ZMP shifts anymore. Indeed, the overlap works a bit like a preview control: the first CoM trajectory is influenced by the second one during the overlap, so it is as if it already knew that there will be another ZMP shift, and adapted consequently.

4 Fig. 5. On the left: a raw sequence of two half-steps avoiding a box on the ground. We can see that the swing foot reaches an unnecessarily high position. After smoothing (on the right), the trajectory has been modified so that the foot moves very close to the obstacle. Fig. 4. We illustrate the smoothing of a raw sequence of half-steps. On the initial raw sequence (on the left), the support paths of the ZMP and CoM trajectories are superimposed. Then, after adjusting the overlaps, the ZMP support path stays the same but the CoM support path becomes smoother (on the right). We can smooth even more, but it reduces the duration of the single support phase that is directly linked with the swing foot speed. Therefore limitations on the swing foot speed constrain the smoothing process. We use the same operators, g 1 and g2, to produce an overlap between the functions of time corresponding to the waist orientation and swing foot position and orientation. Since the inverse geometry for the legs is a continuous function as long as we stay inside the joint limits, these operators used on the bodies trajectories actually implement a simple homotopy that continuously deforms the initial C- space trajectory into a smoother, more dynamic trajectory. In the case of an upward half-step followed by a downward half-step, increasing reduces the duration of the single support phase, and therefore it increases the speed of the swing foot. To limit this effect we must bound. Besides, if is too large undesirable phenomena can occur, such as a negative swing foot height. To avoid these problems we set an upper bound such that the maximum overlap results in a moderately fast gait. 2) Downward then upward: We can apply the same technique to produce an overlap in the case of a downward half-step followed by an upward half-step. Since the last phase of the downward half-step and the first phase of the upward half-step are double support phases, the constraint on the swing foot motion disappears and the maximum bound on becomes simply T. For longer sequences of half-steps, we can simply repeat the procedure to smooth the whole trajectory. Fig. 4 shows the results obtained with an example of raw sequence. After the smoothing, the CoM trajectory is visually smoother and besides, the new trajectory is much faster (about 3 times faster). Changing overlaps inside a sequence of half-steps modifies the whole configuration space trajectory: not only the CoM and ZMP, but also the swing foot trajectory. When the overlap is increased, the swing foot tends to move faster and closer to the ground. If one property must be preserved (for instance the absence of collision), it must be checked after every modification. Since the smoothing by overlap is a continuous operator, we can use dichotomies to quickly find large acceptable values of overlap. Let us consider an example for two consecutive half-steps. We predefine a maximum overlap max and, first, we simulate the part of the trajectory that is modified by the overlap max /2, and check for collisions, self-collisions and joint limits violations. If these three constraints are verified, we try with 3 max /4. Otherwise, we try max /4, etc. We stop and go to the next overlap once we find a good overlap value close enough to a bad overlap value. Fig. 5 shows the effect of the smoothing process on the swing foot trajectory: with the dichotomy we can quickly find a large overlap that keeps the trajectory collision-free. III. PRECOMPUTED SWEPT VOLUME APPROXIMATIONS FOR FAST FOOTSTEP PLANNING The walking pattern generator briefly presented in the previous section is based on half-steps, and they have the good properties of being completely defined with only 3 parameters. Thus, we can obtain a quite dense grid in the parameter space with not too many points. Each point of the grid completely defines a half-step trajectory. Using extensive offline precomputations, we can build approximations of the volume swept by the legs of the robot during these halfsteps. Then, during the footprint planning phase, we can use these approximations to speed up the collision checks. Indeed, the planner often requires the validation of footsteps. This is usually done by checking if collisions occur along the trajectory corresponding to a given footstep. If we only allow the planner to consider footsteps whose half-steps are parametrized by points of our predefined grid, then we can use our swept volume approximations: instead of checking for collisions along discretized trajectories (i.e. hundreds of collision checks per half-step), we simply perform one collision check per half-step: between the environment and the swept volume approximation. A great deal of computation time can be saved using this approach, but it is not trivial to obtain a good planning algorithm that can handle the large set of half-steps (276 in our case). As the complexity of A* quickly increases with the number of half-steps allowed, we opted for an adaptation of the algorithm RRT ([11]) to discrete footstep planning (see [16] for details).

5 We implemented and tested our approach in real-time replanning experiments with the robot HRP-2, in environments where the obstacles and the robot position are acquired by motion capture. This implementation and these experiments are also mentioned in [16], and precisely described in [1]. In these experiments, we used two distinct computers to plan and execute the robot motions: one computer for the planning, and one for the control, the latter being equipped with a real-time operating system. A CORBA server organizes and transfers communications between the 4 units of our architecture: the two computers just mentioned, the motion capture system responsible for obstacles and robot localization, and a viewer that shows in real-time the new paths found by the robot. The control of the robot motion is made with a module called Stack of Tasks (see [12], [13]) which is a structure managing priorities between the active controllers. In an execution thread, the planned trajectory is progressively sent to the control part, while the localization information is read to check for potential collisions. If a collision is detected along the planned trajectory, a query is sent to the planner to generate a new path that tries to link the part of the current trajectory before the expected collisions to the part of the current trajectory after the expected collisions. When the environment is not changing, the planner uses its free time to try to improve parts of the current path, or to smooth the currently planned sequences of steps. The two-phase approach of the trajectory generation is very convenient for online replanning because we control the independence between half-steps in the sense that the smoothing between two consecutive half-steps can easily be canceled. For instance it is easy to unsmooth a part of the currently planned sequence in order to delay a step, or to modify it without modifying the previous steps. With 276 meshes representing our precomputed swept volume approximations, we use the PQP algorithm [10] for collision checks, and during the smoothing process we also use PQP to check for collisions between the environment and convex hulls of the robot bodies (using convex hulls is a bit conservative and slightly reduces the number of triangles). Fig. 6 and Fig. 7 illustrate some of our results in experiments or simulations. The goal and 3D obstacles can be moved in real-time, and the robot tries to adapt its trajectory consequently. An interesting point of the results is that even when stepping over motions are required, the robot can often replan a trajectory very quickly. However, there is some latency and the robot can typically replan the trajectory only 1 or 2 steps after the current one. Fig. 6. On the left: a sequence of steps found in a complex environment. On the right, we show for one sequence of steps the concatenation of the swept volume approximation meshes. For the upper body simpler bounding boxes are used for the collision checks. IV. C ONCLUSION The framework for sound and fast footstep planning briefly presented in this paper and explained in more details in [16] includes a walking pattern generator based on halfsteps, a simple homotopy for trajectory smoothing, swept volume approximations for fast collision checking, and an RRT variant for footstep planning. We used this framework on the robot HRP-2 to quickly plan dynamic sequences of Fig. 7. In this experiment a bar placed 5cm above the ground is moved while the robot is executing its initial plan. (1): HRP-2 starts to execute the sequence initially found. (2): the bar is suddenly moved, and the current sequence of step would lead to collisions. (3): while walking, HRP-2 is able to compute a new sequence of steps towards the goal (we show the concatenation of the swept volumes which indeed avoid the bar). (4): the robot finally steps over the bar while at the same time it tries to optimize the rest of the path towards the goal. Remark: due to uncertainty on positions, we use a model of bar that is thicker than the actual one.

6 walk in environments cluttered with 3D obstacles. Although computed in a few seconds and with some guarantees given by the soundness of the approach, the executed trajectories seem very natural: no pauses, no exaggerated motions to avoid small obstacles, and a large diversity of foot placements. V. ACKNOWLEDGEMENTS This work was supported by a grant from the RBLINK Project, Contrat ANR-08-JCJC REFERENCES [1] L. Baudouin, N. Perrin, T. Moulard, F. Lamiraux, O. Stasse, and E. Yoshida. Small-time controllability of a walking humanoid robot. Accepted to the 11th IEEE/RAS Int. Conf. on Humanoid Robots (Humanoids 11). Available at nperrin/accepted/humanoids11-lbaudouin.pdf, [2] J.-M. Bourgeot, N. Cislo, and B. Espiau. Path-planning and tracking in a 3d complex environment for an anthropomorphic biped robot. In IEEE Int. Conf. on Intelligent Robots and Systems (IROS 02), volume 3, pages , [3] J. Chestnutt, J. J. Kuffner, K. Nishiwaki, and S. Kagami. Planning biped navigation strategies in complex environments. In IEEE/RAS Int. Conf. on Humanoid Robots (Humanoids 03), [4] J. Chestnutt, M. Lau, G. Cheung, J. J. Kuffner, J. Hodgins, and T. Kanade. Footstep planning for the honda asimo humanoid. In IEEE Int. Conf. on Robotics and Automation (ICRA 05), pages , [5] J. Chestnutt, Y. Takaoka, K. Suga, K. Nishiwaki, J. J. Kuffner, and S. Kagami. Biped navigation in rough environments using on-board sensing. In IEEE/RSJ Int. Conf. on Intelligent Robots and Systems (IROS 09), [6] J.-S. Gutmann, M. Fukuchi, and M. Fujita. Real-time path planning for humanoid robot navigation. In Int. Joint Conf. on Artificial Intelligence (IJCAI05), pages , [7] S. Kajita, F. Kanehiro, K. Kaneko, K. Fujiwara, K. Harada, and K. Yokoi. Biped walking pattern generation by using preview control of zero-moment point. In IEEE Int. Conf. on Robotics and Automation (ICRA 03), pages , [8] J. J. Kuffner, K. Nishiwaki, S. Kagami, M. Inaba, and H. Inoue. Footstep planning among obstacles for biped robots. In IEEE/RSJ Int. Conf. on Intelligent Robots and Systems (IROS 01), pages , [9] J. J. Kuffner, K. Nishiwaki, S. Kagami, Y. Kuniyoshi, M. Inaba, and H. Inoue. Online footstep planning for humanoid robots. In IEEE Int. Conf. on Robotics and Automation (ICRA 2003), [10] E. Larsen, S. Gottschalk, M. C. Lin, and D. Manocha. Fast proximity queries with swept sphere volumes. In IEEE Int. Conf. on Robotics and Automation (ICRA 00), pages , [11] S. M. LaValle and J. J. Kuffner. Rapidly-exploring random trees: Progress and prospects. In 4th Workshop on the Algorithmic Foundations of Robotics (WAFR 00), pages , [12] N. Mansard and F. Chaumette. Task Sequencing for Sensor-Based Control. IEEE Trans. on Robotics, 23(1):60 72, February [13] N. Mansard, O. Stasse, P. Evrard, and A. Kheddar. A versatile generalized inverted kinematics implementation for collaborative working humanoid robots: The stack of tasks. In Int. Conf. on Advanced Robotics (ICAR 09)., pages 1 6, [14] K. Nishiwaki, K. Nagasaka, M. Inaba, and H. Inoue. Generation of reactive stepping motion for a humanoid by dynamically stable mixture of pre-designed motions. In 1999 IEEE International Conference on Systems, Man, and Cybernetics, pages vol.1, [15] K. Nishiwaki, T. Sugihara, S. Kagami, M.y. Inaba, and H. Inoue. Online mixture and connection of basic motions for humanoid walking control by footprint specification. In Robotics and Automation, Proceedings 2001 ICRA. IEEE International Conference on, volume 4, pages vol.4, [16] N. Perrin, O. Stasse, Léo Baudouin, F. Lamiraux, and E. Yoshida. Fast humanoid robot collision-free footstep planning using swept volume approximations Accepted to IEEE Trans. on Robotics. Available at TRO_accepted2011.pdf. [17] N. Perrin, O. Stasse, F. Lamiraux, and E. Yoshida. A biped walking pattern generator based on half-steps for dimensionality reduction. In IEEE Int. Conf. on Robotics and Automation (ICRA 11), pages , [18] M. Stilman, K. Nishiwaki, S. Kagami, and J. J. Kuffner. Planning and executing navigation among movable obstacles. In IEEE/RSJ Int. Conf. On Intelligent Robots and Systems (IROS 06), pages , [19] M. Vukobratovic and B. Borovac. Zero-moment point thirty five years of its life. Int. Journal of Humanoid Robotics, 1(1): , [20] E. Yoshida, C. Esteves, I. Belousov, J.-P. Laumond, T. Sakaguchi, and K. Yokoi. Planning 3D collision-free dynamic robotic motion through iterative reshaping. IEEE Trans. on Robotics, 24(5): , 2008.

Real-time Replanning Using 3D Environment for Humanoid Robot

Real-time Replanning Using 3D Environment for Humanoid Robot Real-time Replanning Using 3D Environment for Humanoid Robot Léo Baudouin, Nicolas Perrin, Thomas Moulard, Florent Lamiraux LAAS-CNRS, Université de Toulouse 7, avenue du Colonel Roche 31077 Toulouse cedex

More information

Real-time Replanning Using 3D Environment for Humanoid Robot

Real-time Replanning Using 3D Environment for Humanoid Robot Real-time Replanning Using 3D Environment for Humanoid Robot Léo Baudouin, Nicolas Perrin, Thomas Moulard, Florent Lamiraux, Olivier Stasse, Eiichi Yoshida To cite this version: Léo Baudouin, Nicolas Perrin,

More information

Real-time footstep planning for humanoid robots among 3D obstacles using a hybrid bounding box

Real-time footstep planning for humanoid robots among 3D obstacles using a hybrid bounding box Real-time footstep planning for humanoid robots among 3D obstacles using a hybrid bounding box Nicolas Perrin, Olivier Stasse, Florent Lamiraux, Youn Kim, Dinesh Manocha To cite this version: Nicolas Perrin,

More information

Simplified Walking: A New Way to Generate Flexible Biped Patterns

Simplified Walking: A New Way to Generate Flexible Biped Patterns 1 Simplified Walking: A New Way to Generate Flexible Biped Patterns Jinsu Liu 1, Xiaoping Chen 1 and Manuela Veloso 2 1 Computer Science Department, University of Science and Technology of China, Hefei,

More information

Small-Space Controllability of a Walking Humanoid Robot

Small-Space Controllability of a Walking Humanoid Robot Small-Space Controllability of a Walking Humanoid Robot Se bastien Dalibard, Antonio El Khoury, Florent Lamiraux, Michel Taı x, Jean-Paul Laumond hal-00602384, version 2-19 Sep 2011 CNRS ; LAAS ; 7 avenue

More information

Motion Planning for Humanoid Robots: Highlights with HRP-2

Motion Planning for Humanoid Robots: Highlights with HRP-2 Motion Planning for Humanoid Robots: Highlights with HRP-2 Eiichi Yoshida 1,2 and Jean-Paul Laumond 2 AIST/IS-CNRS/ST2I Joint French-Japanese Robotics Laboratory (JRL) 1 Intelligent Systems Research Institute,

More information

Fast foot prints re-planning and motion generation during walking in physical human-humanoid interaction

Fast foot prints re-planning and motion generation during walking in physical human-humanoid interaction Fast foot prints re-planning and motion generation during walking in physical human-humanoid interaction Olivier Stasse, Paul Evrard, Nicolas Perrin, Nicolas Mansard, Abderrahmane Kheddar Abstract In this

More information

Motion Planning for Whole Body Tasks by Humanoid Robots

Motion Planning for Whole Body Tasks by Humanoid Robots Proceedings of the IEEE International Conference on Mechatronics & Automation Niagara Falls, Canada July 5 Motion Planning for Whole Body Tasks by Humanoid Robots Eiichi Yoshida 1, Yisheng Guan 1, Neo

More information

Humanoid Robotics. Path Planning and Walking. Maren Bennewitz

Humanoid Robotics. Path Planning and Walking. Maren Bennewitz Humanoid Robotics Path Planning and Walking Maren Bennewitz 1 Introduction Given the robot s pose in a model of the environment Compute a path to a target location First: 2D path in a 2D grid map representation

More information

Motion Planning for Humanoid Robots

Motion Planning for Humanoid Robots Motion Planning for Humanoid Robots Presented by: Li Yunzhen What is Humanoid Robots & its balance constraints? Human-like Robots A configuration q is statically-stable if the projection of mass center

More information

Integrating Dynamics into Motion Planning for Humanoid Robots

Integrating Dynamics into Motion Planning for Humanoid Robots Integrating Dynamics into Motion Planning for Humanoid Robots Fumio Kanehiro, Wael Suleiman, Florent Lamiraux, Eiichi Yoshida and Jean-Paul Laumond Abstract This paper proposes an whole body motion planning

More information

Self-Collision Detection. Planning for Humanoid Robots. Digital Human Research Center. Talk Overview

Self-Collision Detection. Planning for Humanoid Robots. Digital Human Research Center. Talk Overview Self-Collision Detection and Motion Planning for Humanoid Robots James Kuffner (CMU & AIST Japan) Digital Human Research Center Self-Collision Detection Feature-based Minimum Distance Computation: Approximate

More information

James Kuffner. The Robotics Institute Carnegie Mellon University. Digital Human Research Center (AIST) James Kuffner (CMU/Google)

James Kuffner. The Robotics Institute Carnegie Mellon University. Digital Human Research Center (AIST) James Kuffner (CMU/Google) James Kuffner The Robotics Institute Carnegie Mellon University Digital Human Research Center (AIST) 1 Stanford University 1995-1999 University of Tokyo JSK Lab 1999-2001 Carnegie Mellon University The

More information

Self-Collision Detection and Prevention for Humanoid Robots. Talk Overview

Self-Collision Detection and Prevention for Humanoid Robots. Talk Overview Self-Collision Detection and Prevention for Humanoid Robots James Kuffner, Jr. Carnegie Mellon University Koichi Nishiwaki The University of Tokyo Satoshi Kagami Digital Human Lab (AIST) Masayuki Inaba

More information

SHORT PAPER Efficient reaching motion planning method for low-level autonomy of teleoperated humanoid robots

SHORT PAPER Efficient reaching motion planning method for low-level autonomy of teleoperated humanoid robots Advanced Robotics, 214 Vol. 28, No. 7, 433 439, http://dx.doi.org/1.18/1691864.213.876931 SHORT PAPER Efficient reaching motion planning method for low-level autonomy of teleoperated humanoid robots Fumio

More information

Leg Motion Primitives for a Humanoid Robot to Imitate Human Dances

Leg Motion Primitives for a Humanoid Robot to Imitate Human Dances Leg Motion Primitives for a Humanoid Robot to Imitate Human Dances Shinichiro Nakaoka 1, Atsushi Nakazawa 2, Kazuhito Yokoi 3 and Katsushi Ikeuchi 1 1 The University of Tokyo,Tokyo, Japan (nakaoka@cvl.iis.u-tokyo.ac.jp)

More information

Instant Prediction for Reactive Motions with Planning

Instant Prediction for Reactive Motions with Planning The 2009 IEEE/RSJ International Conference on Intelligent Robots and Systems October 11-15, 2009 St. Louis, USA Instant Prediction for Reactive Motions with Planning Hisashi Sugiura, Herbert Janßen, and

More information

A Walking Pattern Generator for Biped Robots on Uneven Terrains

A Walking Pattern Generator for Biped Robots on Uneven Terrains A Walking Pattern Generator for Biped Robots on Uneven Terrains Yu Zheng, Ming C. Lin, Dinesh Manocha Albertus Hendrawan Adiwahono, Chee-Meng Chew Abstract We present a new method to generate biped walking

More information

Motion Planning for a Vigilant Humanoid Robot

Motion Planning for a Vigilant Humanoid Robot 9th IEEE-RAS International Conference on Humanoid Robots December 7-10, 2009 Paris, France Motion Planning for a Vigilant Humanoid Robot Jean-Bernard Hayet 1 Claudia Esteves 2 Gustavo Arechavaleta 3 Eiichi

More information

Adaptive Motion Control: Dynamic Kick for a Humanoid Robot

Adaptive Motion Control: Dynamic Kick for a Humanoid Robot Adaptive Motion Control: Dynamic Kick for a Humanoid Robot Yuan Xu and Heinrich Mellmann Institut für Informatik, LFG Künstliche Intelligenz Humboldt-Universität zu Berlin, Germany {xu,mellmann}@informatik.hu-berlin.de

More information

Real-Time Footstep Planning in 3D Environments

Real-Time Footstep Planning in 3D Environments Real-Time Footstep Planning in 3D Environments Philipp Karkowski Stefan Oßwald Maren Bennewitz Abstract A variety of approaches exist that tackle the problem of humanoid locomotion. The spectrum ranges

More information

Leg Motion Primitives for a Dancing Humanoid Robot

Leg Motion Primitives for a Dancing Humanoid Robot Leg Motion Primitives for a Dancing Humanoid Robot Shinichiro Nakaoka, Atsushi Nakazawa, Kazuhito Yokoi and Katsushi Ikeuchi Institute of Industrial Science, The University of Tokyo 4-6-1 Komaba, Meguro-ku,

More information

Motion autonomy for humanoids: experiments on HRP-2 No. 14. Introduction

Motion autonomy for humanoids: experiments on HRP-2 No. 14. Introduction COMPUTER ANIMATION AND VIRTUAL WORLDS Comp. Anim. Virtual Worlds 2009; 20: 511 522 Published online 13 February 2009 in Wiley InterScience (www.interscience.wiley.com).280 Motion autonomy for humanoids:

More information

Dynamically Stepping Over Obstacles by the Humanoid Robot HRP-2

Dynamically Stepping Over Obstacles by the Humanoid Robot HRP-2 Dynamically Stepping Over Obstacles by the Humanoid Robot HRP-2 Björn Verrelst, Olivier Stasse, Kazuhito Yokoi Bram Vanderborght Joint Japanese-French Robotics Laboratory (JRL) Robotics & Multibody Mechanics

More information

Learning Footstep Prediction from Motion. capture

Learning Footstep Prediction from Motion. capture Learning Footstep Prediction from Motion Capture Andreas Schmitz, Marcell Missura, and Sven Behnke University of Bonn, Computer Science VI, Autonomous Intelligent Systems Roemerstr. 164, 53117 Bonn, Germany

More information

Motion Planning of Emergency Stop for Humanoid Robot by State Space Approach

Motion Planning of Emergency Stop for Humanoid Robot by State Space Approach Motion Planning of Emergency Stop for Humanoid Robot by State Space Approach Mitsuharu Morisawa, Kenji Kaneko, Fumio Kanehiro, Shuuji Kajita, Kiyoshi Fujiwara, Kensuke Harada, Hirohisa Hirukawa National

More information

A Local Collision Avoidance Method for Non-strictly Convex Polyhedra

A Local Collision Avoidance Method for Non-strictly Convex Polyhedra A Local Collision Avoidance Method for Non-strictly Convex Polyhedra Fumio Kanehiro, Florent Lamiraux, Oussama Kanoun, Eiichi Yoshida and Jean-Paul Laumond IS/AIST-ST2I/CNRS Joint Japanese-French Robotics

More information

Motion Planning of Human-Like Robots using Constrained Coordination

Motion Planning of Human-Like Robots using Constrained Coordination Motion Planning of Human-Like Robots using Constrained Coordination Liangjun Zhang Jia Pan Dinesh Manocha {zlj,panj,dm}@cs.unc.edu Dept. of Computer Science, University of North Carolina at Chapel Hill

More information

Generating Whole Body Motions for a Biped Humanoid Robot from Captured Human Dances

Generating Whole Body Motions for a Biped Humanoid Robot from Captured Human Dances Generating Whole Body Motions for a Biped Humanoid Robot from Captured Human Dances Shinichiro Nakaoka Atsushi Nakazawa Kazuhito Yokoi Hirohisa Hirukawa Katsushi Ikeuchi Institute of Industrial Science,

More information

Robust Control of Bipedal Humanoid (TPinokio)

Robust Control of Bipedal Humanoid (TPinokio) Available online at www.sciencedirect.com Procedia Engineering 41 (2012 ) 643 649 International Symposium on Robotics and Intelligent Sensors 2012 (IRIS 2012) Robust Control of Bipedal Humanoid (TPinokio)

More information

Intuitive and Flexible User Interface for Creating Whole Body Motions of Biped Humanoid Robots

Intuitive and Flexible User Interface for Creating Whole Body Motions of Biped Humanoid Robots The 2010 IEEE/RSJ International Conference on Intelligent Robots and Systems October 18-22, 2010, Taipei, Taiwan Intuitive and Flexible User Interface for Creating Whole Body Motions of Biped Humanoid

More information

Integrated Perception, Mapping, and Footstep Planning for Humanoid Navigation Among 3D Obstacles

Integrated Perception, Mapping, and Footstep Planning for Humanoid Navigation Among 3D Obstacles Integrated Perception, Mapping, and Footstep Planning for Humanoid Navigation Among 3D Obstacles Daniel Maier Christian Lutz Maren Bennewitz Abstract In this paper, we present an integrated navigation

More information

Online Generation of Humanoid Walking Motion based on a Fast. The University of Tokyo, Tokyo, Japan,

Online Generation of Humanoid Walking Motion based on a Fast. The University of Tokyo, Tokyo, Japan, Online Generation of Humanoid Walking Motion based on a Fast Generation Method of Motion Pattern that Follows Desired ZMP Koichi Nishiwaki 1, Satoshi Kagami 2,Yasuo Kuniyoshi 1, Masayuki Inaba 1,Hirochika

More information

Planning Humanoid Multi-Contact Dynamic Motion using Optimization Techniques

Planning Humanoid Multi-Contact Dynamic Motion using Optimization Techniques Planning Humanoid Multi-Contact Dynamic Motion using Optimization Techniques Abderrahmane KHEDDAR with Karim BOUYARMANE, Adrien ESCANDE, Sébastien LENGAGNE, Sylvain MIOSSEC, Eiichi YOSHIDA CNRS-AIST Joint

More information

An Improved Hierarchical Motion Planner for Humanoid Robots

An Improved Hierarchical Motion Planner for Humanoid Robots 2008 8 th IEEE-RAS International Conference on Humanoid Robots December 1 ~ 3, 2008 / Daejeon, Korea An Improved Hierarchical Motion Planner for Humanoid Robots Salvatore Candido 1, Yong-Tae Kim 2, Seth

More information

Mobility of Humanoid Robots: Stepping over Large Obstacles Dynamically

Mobility of Humanoid Robots: Stepping over Large Obstacles Dynamically Mobility of Humanoid Robots: Stepping over Large Obstacles Dynamically Björn Verrelst, Kazuhito Yokoi, Olivier Stasse, and Hitoshi Arisumi Bram Vanderborght Joint Japanese-French Robotics Laboratory (JRL)

More information

David Galdeano. LIRMM-UM2, Montpellier, France. Members of CST: Philippe Fraisse, Ahmed Chemori, Sébatien Krut and André Crosnier

David Galdeano. LIRMM-UM2, Montpellier, France. Members of CST: Philippe Fraisse, Ahmed Chemori, Sébatien Krut and André Crosnier David Galdeano LIRMM-UM2, Montpellier, France Members of CST: Philippe Fraisse, Ahmed Chemori, Sébatien Krut and André Crosnier Montpellier, Thursday September 27, 2012 Outline of the presentation Context

More information

Real-Time Footstep Planning Using a Geometric Approach

Real-Time Footstep Planning Using a Geometric Approach Real-Time Footstep Planning Using a Geometric Approach Philipp Karkowski Maren Bennewitz Abstract To this date, many footstep planning systems rely on external sensors for mapping and traversability analysis

More information

Using Previous Experience for Humanoid Navigation Planning

Using Previous Experience for Humanoid Navigation Planning Using Previous Experience for Humanoid Navigation Planning Yu-Chi Lin 1 and Dmitry Berenson 1 Abstract We propose a humanoid robot navigation planning framework that reuses previous experience to decrease

More information

Nao Devils Dortmund. Team Description Paper for RoboCup Matthias Hofmann, Ingmar Schwarz, and Oliver Urbann

Nao Devils Dortmund. Team Description Paper for RoboCup Matthias Hofmann, Ingmar Schwarz, and Oliver Urbann Nao Devils Dortmund Team Description Paper for RoboCup 2017 Matthias Hofmann, Ingmar Schwarz, and Oliver Urbann Robotics Research Institute Section Information Technology TU Dortmund University 44221 Dortmund,

More information

Time-Optimal Path Parameterization for Critically Dynamic Motions of Humanoid Robots

Time-Optimal Path Parameterization for Critically Dynamic Motions of Humanoid Robots Time-Optimal Path Parameterization for Critically Dynamic Motions of Humanoid Robots Quang-Cuong Pham and Yoshihiko Nakamura Department of Mechano-Informatics University of Tokyo, Japan Abstract Planning

More information

Interaction Mesh Based Motion Adaptation for Biped Humanoid Robots

Interaction Mesh Based Motion Adaptation for Biped Humanoid Robots Interaction Mesh Based Motion Adaptation for Biped Humanoid Robots Shin ichiro Nakaoka 12 and Taku Komura 1 Abstract Adapting human motion data for humanoid robots can be an efficient way to let them conduct

More information

Collision-free walk planning for humanoid robots using numerical optimization

Collision-free walk planning for humanoid robots using numerical optimization Collision-free walk planning for humanoid robots using numerical optimization Thomas Moulard, Florent Lamiraux, Pierre-Brice Wieber To cite this version: Thomas Moulard, Florent Lamiraux, Pierre-Brice

More information

Vision-Based Trajectory Control for Humanoid Navigation

Vision-Based Trajectory Control for Humanoid Navigation 213 13th IEEE-RAS International Conference on Humanoid Robots (Humanoids). October 15-17, 213. Atlanta, GA Vision-Based Trajectory Control for Humanoid Navigation Giuseppe Oriolo, Antonio Paolillo, Lorenzo

More information

Autonomous and Mobile Robotics Prof. Giuseppe Oriolo. Humanoid Robots 2: Dynamic Modeling

Autonomous and Mobile Robotics Prof. Giuseppe Oriolo. Humanoid Robots 2: Dynamic Modeling Autonomous and Mobile Robotics rof. Giuseppe Oriolo Humanoid Robots 2: Dynamic Modeling modeling multi-body free floating complete model m j I j R j ω j f c j O z y x p ZM conceptual models for walking/balancing

More information

Whole-Body Motion Planning for Manipulation of Articulated Objects

Whole-Body Motion Planning for Manipulation of Articulated Objects Whole-Body Motion Planning for Manipulation of Articulated Objects Felix Burget Armin Hornung Maren Bennewitz Abstract Humanoid service robots performing complex object manipulation tasks need to plan

More information

Motion Planning for Humanoid Walking in a Layered Environment

Motion Planning for Humanoid Walking in a Layered Environment Appear in Proceedings of the IEEE International Conference on Robotics and Automation (ICRA), 2003 Motion Planning for Humanoid Walking in a Layered Environment Tsai-Yen Li Computer Science Department

More information

Planning and Executing Navigation Among Movable Obstacles

Planning and Executing Navigation Among Movable Obstacles Planning and Executing Navigation Among Movable Obstacles Mike Stilman, 1 Koichi Nishiwaki, 2 Satoshi Kagami, 2 James J. Kuffner 1,2 1 The Robotics Institute 2 Digital Human Research Center Carnegie Mellon

More information

Online Environment Reconstruction for Biped Navigation

Online Environment Reconstruction for Biped Navigation Online Environment Reconstruction for Biped Navigation Philipp Michel, Joel Chestnutt, Satoshi Kagami, Koichi Nishiwaki, James Kuffner and Takeo Kanade The Robotics Institute Digital Human Research Center

More information

Planning Whole-body Humanoid Locomotion, Reaching, and Manipulation

Planning Whole-body Humanoid Locomotion, Reaching, and Manipulation Planning Whole-body Humanoid Locomotion, Reaching, and Manipulation Eiichi Yoshida, Claudia Esteves, Oussama Kanoun, Mathieu Poirier, Anthony Mallet, Jean-Paul Laumond and Kazuhito Yokoi Abstract In this

More information

Planning, Execution and Learning Application: Examples of Planning for Mobile Manipulation and Articulated Robots

Planning, Execution and Learning Application: Examples of Planning for Mobile Manipulation and Articulated Robots 15-887 Planning, Execution and Learning Application: Examples of Planning for Mobile Manipulation and Articulated Robots Maxim Likhachev Robotics Institute Carnegie Mellon University Two Examples Planning

More information

Strategies for Humanoid Robots to Dynamically Walk over Large Obstacles

Strategies for Humanoid Robots to Dynamically Walk over Large Obstacles Strategies for Humanoid Robots to Dynamically Walk over Large Obstacles Olivier Stasse, Bjorn Verrelst, Bram Vanderborght, Kazuhito Yokoi To cite this version: Olivier Stasse, Bjorn Verrelst, Bram Vanderborght,

More information

Motion Retargeting for Humanoid Robots Based on Identification to Preserve and Reproduce Human Motion Features

Motion Retargeting for Humanoid Robots Based on Identification to Preserve and Reproduce Human Motion Features 2015 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS) Congress Center Hamburg Sept 28 - Oct 2, 2015. Hamburg, Germany Motion Retargeting for Humanoid Robots Based on Identification

More information

Upper Body Joints Control for the Quasi static Stabilization of a Small-Size Humanoid Robot

Upper Body Joints Control for the Quasi static Stabilization of a Small-Size Humanoid Robot Upper Body Joints Control for the Quasi static Stabilization of a Small-Size Humanoid Robot Andrea Manni, Angelo di Noi and Giovanni Indiveri Dipartimento Ingegneria dell Innovazione, Università di Lecce

More information

Humanoid Teleoperation for Whole Body Manipulation

Humanoid Teleoperation for Whole Body Manipulation Humanoid Teleoperation for Whole Body Manipulation Mike Stilman, Koichi Nishiwaki and Satoshi Kagami Abstract We present results of successful telemanipulation of large, heavy objects by a humanoid robot.

More information

Optimal Motion Planning for Humanoid Robots

Optimal Motion Planning for Humanoid Robots Optimal Motion Planning for Humanoid Robots Antonio El Khoury, Florent Lamiraux, Michel Taïx To cite this version: Antonio El Khoury, Florent Lamiraux, Michel Taïx. Optimal Motion Planning for Humanoid

More information

Autonomous and Mobile Robotics. Whole-body motion planning for humanoid robots (Slides prepared by Marco Cognetti) Prof.

Autonomous and Mobile Robotics. Whole-body motion planning for humanoid robots (Slides prepared by Marco Cognetti) Prof. Autonomous and Mobile Robotics Whole-body motion planning for humanoid robots (Slides prepared by Marco Cognetti) Prof. Giuseppe Oriolo Motivations task-constrained motion planning: find collision-free

More information

Generalizations of the Capture Point to Nonlinear Center of Mass Paths and Uneven Terrain

Generalizations of the Capture Point to Nonlinear Center of Mass Paths and Uneven Terrain Generalizations of the Capture Point to Nonlinear Center of Mass Paths and Uneven Terrain Oscar E. Ramos and Kris Hauser Abstract The classical Capture Point (CP technique allows biped robots to take protective

More information

Quadruped Robots and Legged Locomotion

Quadruped Robots and Legged Locomotion Quadruped Robots and Legged Locomotion J. Zico Kolter Computer Science Department Stanford University Joint work with Pieter Abbeel, Andrew Ng Why legged robots? 1 Why Legged Robots? There is a need for

More information

Control Approaches for Walking and Running

Control Approaches for Walking and Running DLR.de Chart 1 > Humanoids 2015 > Christian Ott > 02.11.2015 Control Approaches for Walking and Running Christian Ott, Johannes Englsberger German Aerospace Center (DLR) DLR.de Chart 2 > Humanoids 2015

More information

A Tiered Planning Strategy for Biped Navigation JOEL CHESTNUTT 1 JAMES J. KUFFNER 1,2

A Tiered Planning Strategy for Biped Navigation JOEL CHESTNUTT 1 JAMES J. KUFFNER 1,2 International Journal of Humanoid Robotics c World Scientific Publishing Company A Tiered Planning Strategy for Biped Navigation JOEL CHESTNUTT 1 JAMES J. KUFFNER 1,2 1 Robotics Institute, Carnegie Mellon

More information

Study on Dynamics Identification of the Foot Viscoelasticity of a Humanoid Robot

Study on Dynamics Identification of the Foot Viscoelasticity of a Humanoid Robot Preprints of the 19th World Congress The International Federation of Automatic Control Cape Town, South Africa. August 24-29, 214 Study on Dynamics Identification of the Foot Viscoelasticity of a Humanoid

More information

Non-Gaited Humanoid Locomotion Planning

Non-Gaited Humanoid Locomotion Planning Non-Gaited Humanoid Locomotion Planning Kris Hauser, Tim Bretl, and Jean-Claude Latombe Stanford University Stanford, CA 94307, USA khauser@cs.stanford.edu, tbretl@stanford.edu, latombe@cs.stanford.edu

More information

Biped Walking Control Based on Hybrid Position/Force Control

Biped Walking Control Based on Hybrid Position/Force Control The 29 IEEE/RSJ International Conference on Intelligent Robots and Systems October -5, 29 St. Louis, USA Biped Walking Control Based on Hybrid Position/Force Control Thomas Buschmann, Sebastian Lohmeier

More information

A sliding walk method for humanoid robots using ZMP feedback control

A sliding walk method for humanoid robots using ZMP feedback control A sliding walk method for humanoid robots using MP feedback control Satoki Tsuichihara, Masanao Koeda, Seiji Sugiyama, and Tsuneo oshikawa Abstract In this paper, we propose two methods for a highly stable

More information

arxiv: v3 [cs.ro] 20 Mar 2017

arxiv: v3 [cs.ro] 20 Mar 2017 Footstep and Motion Planning in Semi-unstructured Environments Using Randomized Possibility Graphs Michael X. Grey 1 Aaron D. Ames 2 C. Karen Liu 3 arxiv:1610.00700v3 [cs.ro] 20 Mar 2017 Abstract Traversing

More information

HUMANOID LOCOMOTION PLANNING FOR VISUALLY-GUIDED TASKS

HUMANOID LOCOMOTION PLANNING FOR VISUALLY-GUIDED TASKS HUMANOID LOCOMOTION PLANNING FOR VISUALLY-GUIDED TASKS Jean-Bernard Hayet, Claudia Esteves, Gustavo Arechavaleta-Servin, Olivier Stasse, Eiichi Yoshida To cite this version: Jean-Bernard Hayet, Claudia

More information

Coordinated Motion Planning for 3D Animation With Use of a Chinese Lion Dance as an Example

Coordinated Motion Planning for 3D Animation With Use of a Chinese Lion Dance as an Example Coordinated Motion Planning for 3D Animation With Use of a Chinese Lion Dance as an Example Fu-Sheng Yu and Tsai-Yen Li Computer Science Department, National Chengchi University, Taiwan, g9331@cs.nccu.edu.tw

More information

COORDINATED MOTION PLANNING FOR 3D ANIMATION USING CHINESE LION DANCE AS AN EXAMPLE. Fu-Sheng Yu and Tsai-Yen Li

COORDINATED MOTION PLANNING FOR 3D ANIMATION USING CHINESE LION DANCE AS AN EXAMPLE. Fu-Sheng Yu and Tsai-Yen Li Appear in Proceedings of International Workshop on Advanced Image Technology, Thailand, 2007. COORDINATED MOTION PLANNING FOR 3D ANIMATION USING CHINESE LION DANCE AS AN EXAMPLE Fu-Sheng Yu and Tsai-Yen

More information

Humanoid Robotics. Inverse Kinematics and Whole-Body Motion Planning. Maren Bennewitz

Humanoid Robotics. Inverse Kinematics and Whole-Body Motion Planning. Maren Bennewitz Humanoid Robotics Inverse Kinematics and Whole-Body Motion Planning Maren Bennewitz 1 Motivation Planning for object manipulation Whole-body motion to reach a desired goal configuration Generate a sequence

More information

A 2-Stages Locomotion Planner for Digital Actors

A 2-Stages Locomotion Planner for Digital Actors A 2-Stages Locomotion Planner for Digital Actors Julien Pettré LAAS-CNRS 7, avenue du Colonel Roche 31077 Cedex 4 Toulouse, FRANCE Jean-Paul Laumond LAAS-CNRS 7, avenue du Colonel Roche 31077 Cedex 4 Toulouse,

More information

Walking without thinking about it

Walking without thinking about it Walking without thinking about it Andrei Herdt, Nicolas Perrin, Pierre-Brice Wieber To cite this version: Andrei Herdt, Nicolas Perrin, Pierre-Brice Wieber Walking without thinking about it IROS 1 - IEEE-RSJ

More information

Hierarchical Optimization-based Planning for High-DOF Robots

Hierarchical Optimization-based Planning for High-DOF Robots Hierarchical Optimization-based Planning for High-DOF Robots Chonhyon Park and Jia Pan and Dinesh Manocha Abstract We present an optimization-based motion planning algorithm for high degree-of-freedom

More information

Planning Support Contact-Points for Acyclic Motions and Experiments on HRP-2

Planning Support Contact-Points for Acyclic Motions and Experiments on HRP-2 Planning Support Contact-Points for Acyclic Motions and Experiments on HRP-2 Adrien Escande, Abderrahmane Kheddar, Sylvain Miossec, Sylvain Garsault To cite this version: Adrien Escande, Abderrahmane Kheddar,

More information

Safe motion planning computation for databasing balanced movement of Humanoid Robots

Safe motion planning computation for databasing balanced movement of Humanoid Robots 2009 IEEE International Conference on Robotics and Automation Kobe International Conference Center Kobe, Japan, May 12-17, 2009 Safe motion planning computation for databasing balanced movement of Humanoid

More information

Humanoid Robotics. Inverse Kinematics and Whole-Body Motion Planning. Maren Bennewitz

Humanoid Robotics. Inverse Kinematics and Whole-Body Motion Planning. Maren Bennewitz Humanoid Robotics Inverse Kinematics and Whole-Body Motion Planning Maren Bennewitz 1 Motivation Plan a sequence of configurations (vector of joint angle values) that let the robot move from its current

More information

Balanced Walking with Capture Steps

Balanced Walking with Capture Steps Balanced Walking with Capture Steps Marcell Missura and Sven Behnke Autonomous Intelligent Systems, Computer Science, Univ. of Bonn, Germany {missura,behnke}@cs.uni-bonn.de http://ais.uni-bonn.de Abstract.

More information

Biped Walking Pattern Generation by using Preview Control of Zero-Moment Point

Biped Walking Pattern Generation by using Preview Control of Zero-Moment Point Proceedings of the 23 IEEE International Conference on Robotics & Automation Taipei, Taiwan, September 4-9, 23 Biped Walking Pattern Generation by using Preview Control of Zero-Moment Point Shuuji KAJITA,

More information

Modelling and simulation of the humanoid robot HOAP-3 in the OpenHRP3 platform

Modelling and simulation of the humanoid robot HOAP-3 in the OpenHRP3 platform Modelling and simulation of the humanoid robot -3 in the 3 platform C.A. Monje, P. Pierro, T. Ramos, M. González-Fierro, C. Balaguer. Abstract The aim of this work is to model and simulate the humanoid

More information

Development of Vision System on Humanoid Robot HRP-2

Development of Vision System on Humanoid Robot HRP-2 Development of Vision System on Humanoid Robot HRP-2 Yutaro Fukase Institute of Technology, Shimizu Corporation, Japan fukase@shimz.co.jp Junichiro Maeda Institute of Technology, Shimizu Corporation, Japan

More information

Inverse Kinematics for Humanoid Robots using Artificial Neural Networks

Inverse Kinematics for Humanoid Robots using Artificial Neural Networks Inverse Kinematics for Humanoid Robots using Artificial Neural Networks Javier de Lope, Rafaela González-Careaga, Telmo Zarraonandia, and Darío Maravall Department of Artificial Intelligence Faculty of

More information

arxiv: v1 [cs.ro] 23 May 2018

arxiv: v1 [cs.ro] 23 May 2018 Tool Exchangeable Grasp/Assembly Planner Kensuke Harada 1,2, Kento Nakayama 1, Weiwei Wan 1,2, Kazuyuki Nagata 2 Natsuki Yamanobe 2, and Ixchel G. Ramirez-Alpizar 1 arxiv:1805.08962v1 [cs.ro] 23 May 2018

More information

A CONTROL ARCHITECTURE FOR DYNAMICALLY STABLE GAITS OF SMALL SIZE HUMANOID ROBOTS. Andrea Manni,1, Angelo di Noi and Giovanni Indiveri

A CONTROL ARCHITECTURE FOR DYNAMICALLY STABLE GAITS OF SMALL SIZE HUMANOID ROBOTS. Andrea Manni,1, Angelo di Noi and Giovanni Indiveri A CONTROL ARCHITECTURE FOR DYNAMICALLY STABLE GAITS OF SMALL SIZE HUMANOID ROBOTS Andrea Manni,, Angelo di Noi and Giovanni Indiveri Dipartimento di Ingegneria dell Innovazione, Università di Lecce, via

More information

Fast and Dynamically Stable Optimization-based Planning for High-DOF Human-like Robots

Fast and Dynamically Stable Optimization-based Planning for High-DOF Human-like Robots Fast and Dynamically Stable Optimization-based Planning for High-DOF Human-like Robots Chonhyon Park and Dinesh Manocha http://gamma.cs.unc.edu/itomp/ (Videos included) Abstract We present a novel optimization-based

More information

Human Motion Tracking Control with Strict Contact Force Constraints for Floating-Base Humanoid Robots

Human Motion Tracking Control with Strict Contact Force Constraints for Floating-Base Humanoid Robots 2013 13th IEEE-RAS International Conference on Humanoid Robots (Humanoids). October 15-17, 2013. Atlanta, GA Human Motion Tracking Control with Strict Contact Force Constraints for Floating-Base Humanoid

More information

Motion Planning of Ladder Climbing for Humanoid Robots

Motion Planning of Ladder Climbing for Humanoid Robots Motion Planning of Ladder Climbing for Humanoid Robots Yajia Zhang, Jingru Luo, Kris Hauser School of Informatics & Computing Indiana University Bloomington, IN 47408 Robert Ellenberg, Paul Oh Mechanical

More information

Experimental Evaluation of the Dynamic Simulation of Biped Walking of Humanoid Robots

Experimental Evaluation of the Dynamic Simulation of Biped Walking of Humanoid Robots Proceedings of the 2003 IEEE International Conference on Robotics & Automation Taipei, Taiwan, September 14-19, 2003 Experimental Evaluation of the Dynamic Simulation of Biped Walking of Humanoid Robots

More information

Tracking Minimum Distances between Curved Objects with Parametric Surfaces in Real Time

Tracking Minimum Distances between Curved Objects with Parametric Surfaces in Real Time Tracking Minimum Distances between Curved Objects with Parametric Surfaces in Real Time Zhihua Zou, Jing Xiao Department of Computer Science University of North Carolina Charlotte zzou28@yahoo.com, xiao@uncc.edu

More information

CS 4649/7649 Robot Intelligence: Planning

CS 4649/7649 Robot Intelligence: Planning CS 4649/7649 Robot Intelligence: Planning Probabilistic Roadmaps Sungmoon Joo School of Interactive Computing College of Computing Georgia Institute of Technology S. Joo (sungmoon.joo@cc.gatech.edu) 1

More information

Real Time Biped Walking Gait Pattern Generator for a Real Robot

Real Time Biped Walking Gait Pattern Generator for a Real Robot Real Time Biped Walking Gait Pattern Generator for a Real Robot Feng Xue 1, Xiaoping Chen 1, Jinsu Liu 1, and Daniele Nardi 2 1 Department of Computer Science and Technology, University of Science and

More information

Evolutionary Motion Design for Humanoid Robots

Evolutionary Motion Design for Humanoid Robots Evolutionary Motion Design for Humanoid Robots Toshihiko Yanase Department of Frontier Informatics The University of Tokyo Chiba 277-8561, Japan yanase@iba.k.u-tokyo.ac.jp Hitoshi Iba Department of Frontier

More information

HUMANOID LOCOMOTION PLANNING FOR VISUALLY GUIDED TASKS

HUMANOID LOCOMOTION PLANNING FOR VISUALLY GUIDED TASKS International Journal of Humanoid Robotics Vol. 9, No. 2 (2012) 1250009 (26 pages) c World Scienti c Publishing Company DOI: 10.1142/S0219843612500090 HUMANOID LOCOMOTION PLANNING FOR VISUALLY GUIDED TASKS

More information

Using the Generalized Inverted Pendulum to generate less energy-consuming trajectories for humanoid walking

Using the Generalized Inverted Pendulum to generate less energy-consuming trajectories for humanoid walking Using the Generalized Inverted Pendulum to generate less energy-consuming trajectories for humanoid walking Sahab Omran, Sophie Sakka, Yannick Aoustin To cite this version: Sahab Omran, Sophie Sakka, Yannick

More information

Real-Time Smooth Task Transitions for Hierarchical Inverse Kinematics

Real-Time Smooth Task Transitions for Hierarchical Inverse Kinematics 03 3th IEEE-RAS International Conference on Humanoid Robots (Humanoids). October 5-7, 03. Atlanta, GA Real-Time Smooth Task Transitions for Hierarchical Inverse Kinematics Gerardo Jarquín, Adrien Escande,

More information

Inverse Kinematics for Humanoid Robots Using Artificial Neural Networks

Inverse Kinematics for Humanoid Robots Using Artificial Neural Networks Inverse Kinematics for Humanoid Robots Using Artificial Neural Networks Javier de Lope, Rafaela González-Careaga, Telmo Zarraonandia, and Darío Maravall Department of Artificial Intelligence Faculty of

More information

Real-Time Navigation in 3D Environments Based on Depth Camera Data

Real-Time Navigation in 3D Environments Based on Depth Camera Data Real-Time Navigation in 3D Environments Based on Depth Camera Data Daniel Maier Armin Hornung Maren Bennewitz Abstract In this paper, we present an integrated approach for robot localization, obstacle

More information

Path Planning in Dimensions Using a Task-Space Voronoi Bias

Path Planning in Dimensions Using a Task-Space Voronoi Bias Path Planning in 1000+ Dimensions Using a Task-Space Voronoi Bias Alexander Shkolnik and Russ Tedrake Abstract The reduction of the kinematics and/or dynamics of a high-dof robotic manipulator to a low-dimension

More information

Torque-Position Transformer for Task Control of Position Controlled Robots

Torque-Position Transformer for Task Control of Position Controlled Robots 28 IEEE International Conference on Robotics and Automation Pasadena, CA, USA, May 19-23, 28 Torque-Position Transformer for Task Control of Position Controlled Robots Oussama Khatib, 1 Peter Thaulad,

More information

Feasibility and Optimization of Fast Quadruped Walking with One- Versus Two-at-a-Time Swing Leg Motions for RoboSimian

Feasibility and Optimization of Fast Quadruped Walking with One- Versus Two-at-a-Time Swing Leg Motions for RoboSimian Feasibility and Optimization of Fast Quadruped Walking with One- Versus Two-at-a-Time Swing Leg Motions for RoboSimian Peter Ha and Katie Byl Abstract This paper presents two planning methods for generating

More information

A robust linear MPC approach to online generation of 3D biped walking motion

A robust linear MPC approach to online generation of 3D biped walking motion A robust linear MPC approach to online generation of 3D biped walking motion Camille Brasseur, Alexander Sherikov, Cyrille Collette, Dimitar Dimitrov, Pierre-Brice Wieber To cite this version: Camille

More information