Humanoid Full-Body Manipulation Motion Planning. with Multiple Initial-Guess and Key Postures

Size: px
Start display at page:

Download "Humanoid Full-Body Manipulation Motion Planning. with Multiple Initial-Guess and Key Postures"

Transcription

1 Humanoid Full-Body Manipulation Motion Planning with Multiple Initial-Guess and Key Postures Ph.D Research Qualification Report Department of Mechanical Engineering Bowei Tang September 15, 2014 Bowei Tang, is with the Department of Mechanical Engineering at Carnegie Mellon University, supervised by Prof. Chris G. Atkeson and Prof. Hartmut Geyer

2 Abstract Whole body manipulation plays a very important role in the usage of humanoid robot, which meet the requirement of service and household in domestic environment, as well as disaster recover in extreme environment. Because of the high redundancy system, optimization methods are widely used to solve Inverse Kinematics (IK) of humanoid robot. However, most of current methods suffer a problem of getting stacked in local minimum or singularities, and lack of the ability to generate diverse motions. In this paper, we present an optimization method to solve high redundancy IK problems and generate a good optimal trajectory for humanoid robot full-body manipulation statics motion. Our algorithm could effectively avoid unexpected local minimum solutions caused by bad initial guess and develop diverse motion variations. The basic idea of our algorithm is to generate multiple diverse initial guesses for each manually set key postures, use traditional optimization method to generate optimal solutions based on these initial guesses. Then we evaluate those optimal solutions inside the whole motion process and find the best optimal solution series. Finally, we interpolate the discrete solution series into a smooth trajectory. The performance of our approach is implemented in Gazebo simulation using Atlas by Boston Dynamics.

3 1 Introduction The DARPA Robotics Challenge (DRC) is designed to evolve humanoid robots that can work in disaster and hazardous environments. Several tasks in DRC, such as the debris task and manipulation tasks, involve an accurate, reliable and fast whole body manipulation ability and performing kinematically complex motions. It has been widely known that getting an optimal trajectory of humanoid robots whole body manipulation is a very difficult issue due to the complexity of the humanoids kinematics and task requirements. In this paper, we introduce a full body trajectory optimization approach for the simulation phase of humanoid Atlas, a 28-DOF (degree of freedom) hydraulic robot built by Boston Dynamics. Because of the inaccuracy of high force hydraulic actuator and sensor, it is very difficult to apply torque control from a result of dynamic trajectory optimization directly into the whole body manipulation. Instead, we use statics motion to track the joint space trajectory. It has been hypothesized that many of these complex trajectories could be divided into the combination of a series of simple actions. The computational cost of the optimization of a single pose inverse kinematics is much less than the optimization of a whole trajectory. A reasonable integration of a trajectory across these stable key poses will remain stable. In that case, our approach could find better optimal solution of each key poses and reduce the optimization time greatly. The remainder of this paper is organized as follows: Section II introduced some of widely used methods to solve inverse kinematics problems with optimization approach. Section III presents our multi initial guess algorithms to find the optimal trajectory. Section IV demonstrate how our algorithm works on the Debris Task in DRC. Finally, Section V concludes the paper and discuss the advantage of our algorithm. 1

4 2 Related Work Generating relatively impressive motion trajectories can be very slow [1][2], or have n- ever been used on real robots [3] and usually do not take into account the richness of the information created by the available sensors. Due to the kinematics redundancy, there is no analytical unique solutions for inverse kinematics (IK) problem with larger than six degrees of freedom(dof) [4]. Instead, numerical techniques based on pseudo-inverse of Jacobian matrices J, the optimization methods and Rapidly-exploring Random Trees (RRTs) are widely used. Directly solve the IK problems using pseudo inverse of Jacobian Matrix [5][6][7] is not conservative and not always easy to determine the constraints. These issues motivated researchers to focus on resolving kinematic redundancies with optimization methods like extended Jacobian method[6], Particle Swarm Optimization[8], dynamic programming [9] [10], or non-linear optimization[11]. However, the complexity of humanoid robot makes the objective function not convex and full of local minimum. As a result, the solution always converge to a strange and unreliable pose. In that case, the optimization result is highly depends on initial guess. In order to get a reasonable initial guess for a better trajectory optimization result, many researches focus on tracking a reference pre-recorded human motion based on motion capture data [12] [13] for generation of physically-simulated humanoid character [14][15][16] that has human-like motions [17]. Human motion data is a very reasonable initial guess with the similar kinematic structure and by good scaling approach to transmit human kinematics parameter into humanoid s [18][19][20]. This method lack of flexibility for different unknown tasks and environments, so there are also algorithms that learn from examples and formulate feasible fullbody plans to traverse a new environment [21] or build a library of optimal trajectories [22]. With the development of computer hardware, more researches have been developed for 2

5 exploring optimal humanoid motion trajectory without pre-record data. Mordatch [3], Borno [1], Ramos [23] developed a class of approaches aiming at identifying functional principles of human movements. There are also research focusing on generating different kinds of motions [24][25] with great mount of computing cost. We extend previous work and argue that the trajectory generation process could be divided into the automatic planning phase and real time practice phase. During the planning phase, we generate multiple kinds of optimal trajectory libraries; during the practice phase, we use the trajectory libraries as initial guess and online optimize a modified trajectory for real environment. 3 Algorithm Instead of using neighboring optimal control method to generate local approximations to the optimal control [22], our approach focuses on integrating full-body trajectory from a series of globally optimal key poses and find local minimum solutions for each posture. Similar to previous research about humanoid animation that divided trajectory into key frames [26] or short space-time windows [1], we define panel points of the whole tasks as the key poses. For a single posture, with different initial guess, we could have multiple local minimum solutions that could all achieve task requirements and follow the constraints and penalties. Then we evaluate the solution series to get the global optimal pose series, associate these key poses as the variable and use these solutions as the value to find the best solution in the pose series. Finally, we generate the trajectory based on the optimal key poses. 3.1 Define Key Postures and Objective Functions The key postures should contain major differences in body pose, contact situation and action purpose. For a certain task, there are four kinds of key postures: the initial posture that connect to previous action, the final posture that connect to the next action, the task postures that is 3

6 required to finish the goal of the task, the preparation postures that could avoid obstacles and connect the task postures. A common way to define the key postures should be directly using human experience and work for effective Human-in-the-Loop control [27]. If we want to offer the robot a general framework towards autonomy and versatility, we may use reinforcement learning [28] [29][30] to train the robot. In this research, we did not focus on the learning phase, so we directly use human input for our simulation test. In one single key posture k, we use the same cost functions L k : L k (q) = ω i J i (q τ,p) (1) i where q is the joint angle set; τ is the joint torque set; p is the 6-D position of end effector, here it is the position of left hand. We want robot s operational hand to reach the target, so the cost function of end effectors is: J e f (q) = m i=1 ω i [P i p i (q)] 2 (2) where m is the number of end-effector ω i is a constant weight to measure the importance of the target i; P i is the goal of the i th end effector, p i (q) is the position of i th end effector computed through Forward Kinematics. By setting multiple end effectors, we could control the positions of all the necessary parts of the robot besides hands. We want the robot to stand balance in a static position. So we use: J c (q) = (c c) T (c c) (3) to move the center of mass c to the desired position c. We also want to penalize joint torques that balanced gravity at each posture, so we set the third term: J t (q) = τ (q) T Wτ (q) (4) 4

7 to reduce the sum of torques at each joints follows a series of manually designed weight. Here τ(q) is the joint torque set computed through Inverse Dynamics to balance the gravity; the weight matrix W is a diagonal matrix with the weights of each joints at the diagonal elements. Even with the penalties, the solution will still fall into a bad local minimum. For the purpose of accuracy, we also set the position of the executing end effector, left hand of Atlas, as a constraint. So we force the end effector into the right place with the right orientation by the constraints: p i (q) = P i,i = 1,2,...,m (5) We also want the robot to follow its kinematic limitations: q min q q max (6) and dynamic limitations: τ min τ (q) τ max (7) 3.2 Distribute initial guesses to cover the whole joint space In order to find different available postures for generating the approximate global minimum trajectory, we need to generate the initial guess as different from each other as possible [24] so that we could cover the whole working space the best. This is achieved by the diversity object function: E IG = M M ( d(qi,q j ) + Kd min (q i,q 0 ) i=0( ) ) + C i (q i ) j=0 i where q is the joint angle set, M is the total number of initial guess d(q i,q j ) = M k=1 (q i q j ) T W(q i q j ) is the distance measurement between two joint angle sets with a weight matrix W that distinguish the importance of each joint. q 0 is a zero definite vector in joint space. d min (q i,q 0 ) is the minimal distance of all joint set to zero vector. K is a weighting constant affect the distribute of the initial guesses. C i is the constraint function that could limit the (8) 5

8 initial guess close to the optimal solutions. With this objective function, we could make the initial guess joint set covers as much of the joint space as possible[24]. 3.3 Find the optimization solution of single key pose SNOPT is a general-purpose system for constrained optimization using sparse Sequential Quadratic Programming (SQP) method [31]. We use it to compute the optimal solution of the objective function (1) for posture k with the given initial guess ig i. q k i : argmin q k R 28 L k (q ig i ) 3.4 Evaluate trajectory In order to reduce computational complexity in trajectory optimization for humanoid robot, we just focus on the performance of the key poses and ignore the process between each nearby key poses. So the trajectory is reconstructed as a combination of a series of key poses. We define the solutions in each key pose as the variables: [ ] T X = S 1 S 2... S n (9) where S i is the solution of key pose i. Each key pose has a library of available optimal solutions from previous step. We use these solutions as the value to do optimization: L traj (X ) = ω i E i (X ) (10) i X : argminl traj (X ) (11) X Since all the available solutions are balanced and reach the target requirement, we do not set these two solid requirements as the penalties in this step Total torque The torque of each poses has been optimized, we do not focus on the maximum torque of the trajectory. Instead, we consider the sum of torques of each poses and find the minimum 6

9 trajectory: E t = n i=1 τ (q i ) T W t τ (q i ) (12) where n is the number of key poses. τ (q i ) is the torque vector of key posture i, W t is weight matrix for each joint to measure the importance of each joint torques Differences in joint space In order to reduce uncertainty, we want the robot to move as little as possible between each key pose. So the change of joint angles is also a penalty that is required to be minimized. E a = n+1 i=1 (q i q i 1 ) T W a (q i q i 1 ) (13) where n is the number of key poses, q 0 represent initial pose, q n+1 represent final pose. W a is weight matrix for each joint to measure the importance of each joint displacement. For example, we do not want much movement for the major joint such as hip, knee or waist, so we gives a large number of weights for them; but some joint are not that important for balancing such as wrist or neck, so they have smaller weights. 3.5 Generate trajectory We directly compute N = n i=1 m i trajectories and find the best key posture series with the least cost following Function (11). Here n is the total number of Key Postures, we have n = 4 in our experiment, m i is the number of solutions in Key Posture i. In order to get a continuous motion, we need to fill the points between the nearby postures. We use the Lagrange method to interpolate the inner points with the computed key posture series. q(t) = n j=1 q j n i=1 i j t t i,t km,t N (14) t j t i where t is the interpolated points, t i = im and t j = jm are the points at node i and j. n is the total number of key postures, N is the number of interpolated points between nearby key poses. 7

10 Through Lagrange Interpolation, we could get a smooth and continuous trajectory passing through all the key postures. However, even if this trajectory is built from the combination of the global solutions, we still need to consider the disturbance of the unknown environment. We then use the integrated optimal trajectory as the initial guess of the real motion at each point, then re-solve the Inverse Kinematics and find the optimal trajectory of each step. Since the preoptimized initial guess is already satisfied the task requirement and very close to the optimal motion, the process will be fast enough for online optimization. Our algorithm not only compute the motion planning of humanoid robot, but could also extended to many other motion planning problems with large workable space and Human-inthe-Loop control. 4 Experiment In this section, we demonstrate the performance of our algorithm through the Debris Task in DARPA Robotics Challenges using the 28 DOFs Altas humanoid created by Boston Dynamics. The motion process starts from a initial posture that the robot stand balanced with two arm place on the sides of its body and end up with the same posture. The end effector is the operational right hand. We also set the position and direction of two feet so that the robot will not step when doing the grasping action. In the grasping action of one wood strip, we manually define four Key Postures: Prepare, Grasp, Lift up and Throw, as Fig. 1 shows. 4.1 Compute different optimal solutions In each of specific pre-defined key posture, we distribute 15 Initial Guesses, thus we could find optimal solutions from these initial guesses. Fig. 2 shows four different postures that have the same propose with the same end effector position. 8

11 (a) Pre-grasp (b) Grasp (c) Up-Lift (d) Throw Figure 1: Four Key Postures for grasping the one strip in Debris Task (a) Action-1 (b) Action-2 (c) Action-3 (d) Action-4 Figure 2: Multiple Optimal Solutions for Grasping Posture 4.2 Generate Trajectory Once we have mi (mi 15) optimal solutions for key posture i, we could generate N = ni=1 mi trajectories. From these N trajectories, we could find the best one according to Func (10). The best trajectory is shown in Fig. 3. In addition, we could also find the next best action, third best action, which could give us many other diverse motion options. 5 Conclusion and Discussion We have presented a full-body trajectory optimization method that relies on manually set key postures with multiple optimal initial guesses. We show that this method could get a better trajectory with less movement and more stability during the whole motion process. Another important advantage of our approach is the ability to find diverse styles of actions for a certain task with the multiple initial guesses and optimal solutions, thus we could generate different 9

12 (a) Stand (b) Pre-Grasp (c) Grasp (d) Up-Lift (e) Throw (f) Stand Back Figure 3: Whole process of the grasping action trajectories for different purposes. Our approach could effectively avoid local minimum and find diverse workable motion styles in a less constraint working environment. However, this method suffers a disadvantage that if the working area is small, we could hardly find a workable solution for any key posture with finite initial guess. For example, in DRC task 1, Atlas robot needs to get its huge body out of the small car, which leaves us a very narrow working space. In that case, very few or even none of the multiple solutions from our multiple initial guesses will work. As a result, we need to combine the differential Inverse Kinematic method into our approach that could effectively connect to previous working posture. Future research will focus on developing an advanced key posture generator that could automatically define the key poses given a certain task and working environment. The basic framework of using multiple initial guess for diverse optimal trajectory could also be extended to dynamic trajectory optimization, thus increase the speed of dynamic online optimization. 10

13 References [1] M. Al Borno, M. De Lasa, and A. Hertzmann, Trajectory optimization for full-body movements with complex contacts, Visualization and Computer Graphics, IEEE Transactions on, vol. 19, no. 8, pp , Aug [2] S. Lengagne, P. Mathieu, A. Kheddar, and E. Yoshida, Generation of dynamic motions under continuous constraints: Efficient computation using b-splines and taylor polynomials, in Intelligent Robots and Systems (IROS), 2010 IEEE/RSJ International Conference on, Oct 2010, pp [3] I. Mordatch, E. Todorov, and Z. Popović, Discovery of complex behaviors through contact-invariant optimization, ACM Transactions on Graphics (TOG), vol. 31, no. 4, p. 43, [4] J. J. Craig, Introduction to robotics: mechanics and control. Pearson/Prentice Hall Upper Saddle River, NJ, USA:, [5] A. D Souza, S. Vijayakumar, and S. Schaal, Learning inverse kinematics, in Intelligent Robots and Systems, Proceedings IEEE/RSJ International Conference on, vol. 1, 2001, pp vol.1. [6] G. Tevatia and S. Schaal, Inverse kinematics for humanoid robots, in Robotics and Automation, Proceedings. ICRA 00. IEEE International Conference on, vol. 1, 2000, pp vol.1. [7] C. Chevallereau and W. Khalil, A new method for the solution of the inverse kinematics of redundant robots, in Robotics and Automation, Proceedings., 1988 IEEE International Conference on, Apr 1988, pp vol.1. 11

14 [8] C. Niehaus, T. Röfer, and T. Laue, Gait optimization on a humanoid robot using particle swarm optimization, in Proceedings of the Second Workshop on Humanoid Soccer Robots in conjunction with the, [9] W. Suleiman, E. Yoshida, J.-P. Laumond, and A. Monin, On humanoid motion optimization, in Humanoid Robots, th IEEE-RAS International Conference on, Nov 2007, pp [10] T. Mandersloot, M. Wisse, and C. Atkeson, Controlling velocity in bipedal walking: A dynamic programming approach, in Humanoid Robots, th IEEE-RAS International Conference on, Dec 2006, pp [11] M. Do, P. Azad, T. Asfour, and R. Dillmann, Imitation of human motion on a humanoid robot using non-linear optimization, in Humanoid Robots, Humanoids th IEEE-RAS International Conference on, Dec 2008, pp [12] N. Pollard, J. Hodgins, M. Riley, and C. Atkeson, Adapting human motion for the control of a humanoid robot, in Robotics and Automation, Proceedings. ICRA 02. IEEE International Conference on, vol. 2, 2002, pp vol.2. [13] A. Safonova, N. Pollard, and J. K. Hodgins, Optimizing human motion for the control of a humanoid robot, Proc. Applied Mathematics and Applications of Mathematics, vol. 78, [14] K. W. Sok, M. Kim, and J. Lee, Simulating biped behaviors from human motion data, in ACM Transactions on Graphics (TOG), vol. 26, no. 3. ACM, 2007, p [15] Y. Lee, S. Kim, and J. Lee, Data-driven biped control, ACM Transactions on Graphics (TOG), vol. 29, no. 4, p. 129,

15 [16] M. Da Silva, Y. Abe, and J. Popović, Simulation of human motion data using shorthorizon model-predictive control, in Computer Graphics Forum, vol. 27, no. 2. Wiley Online Library, 2008, pp [17] T. Asfour and R. Dillmann, Human-like motion of a humanoid robot arm based on a closed-form solution of the inverse kinematics problem, in Intelligent Robots and Systems, (IROS 2003). Proceedings IEEE/RSJ International Conference on, vol. 2, Oct 2003, pp vol.2. [18] A. Ude, C. Man, M. Riley, and C. G. Atkeson, Automatic generation of kinematic models for the conversion of human motion capture data into humanoid robot motion, [19] A. Ude, C. G. Atkeson, and M. Riley, Programming full-body movements for humanoid robots by observation, Robotics and Autonomous Systems, vol. 47, no. 2, pp , [20] K. Grochow, S. L. Martin, A. Hertzmann, and Z. Popović, Style-based inverse kinematics, ACM Trans. Graph., vol. 23, no. 3, pp , Aug [Online]. Available: [21] C. Dellin and S. Srinivasa, A framework for extreme locomotion planning, in Robotics and Automation (ICRA), 2012 IEEE International Conference on, May 2012, pp [22] C. Liu and C. Atkeson, Standing balance control using a trajectory library, in Intelligent Robots and Systems, IROS IEEE/RSJ International Conference on, Oct 2009, pp

16 [23] O. Ramos, N. Mansard, O. Stasse, and P. Souères, An advanced robotics motion generation framework for inferring the organisation of human movements, Computer methods in biomechanics and biomedical engineering, vol. 16, no. sup1, pp , [24] S. Agrawal, S. Shen, and M. van de Panne, Diverse motion variations for physics-based character animation, in Proceedings of the 12th ACM SIGGRAPH/Eurographics Symposium on Computer Animation. ACM, 2013, pp [25] S. Agrawal and M. van de Panne, Pareto optimal control for natural and supernatural motions, in Proceedings of the Motion on Games. ACM, 2013, pp [26] J. Chai and J. K. Hodgins, Constraint-based motion optimization using a statistical dynamic model, ACM Transactions on Graphics (TOG), vol. 26, no. 3, p. 8, [27] A. Leeper, K. Hsiao, M. Ciocarlie, L. Takayama, and D. Gossow, Strategies for humanin-the-loop robotic grasping, in Human-Robot Interaction (HRI), th ACM/IEEE International Conference on, March 2012, pp [28] J. Morimoto and K. Doya, Acquisition of stand-up behavior by a real robot using hierarchical reinforcement learning, Robotics and Autonomous Systems, vol. 36, no. 1, pp , [29] J. Peters, S. Vijayakumar, and S. Schaal, Reinforcement learning for humanoid robotics, in Proceedings of the third IEEE-RAS international conference on humanoid robots, 2003, pp [30] T. Hester, M. Quinlan, and P. Stone, Generalized model learning for reinforcement learning on a humanoid robot, in Robotics and Automation (ICRA), 2010 IEEE International Conference on, May 2010, pp

17 [31] P. Gill, W. Murray, and M. Saunders, SNOPT: an SQP Algorithm for Large-Scale Constrained Optimization, SIAM journal on optimization, vol. 12, no. 4, pp ,

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

Controlling Humanoid Robots with Human Motion Data: Experimental Validation

Controlling Humanoid Robots with Human Motion Data: Experimental Validation 21 IEEE-RAS International Conference on Humanoid Robots Nashville, TN, USA, December 6-8, 21 Controlling Humanoid Robots with Human Motion Data: Experimental Validation Katsu Yamane, Stuart O. Anderson,

More information

Full-body Motion Planning and Control for The Car Egress Task of the DARPA Robotics Challenge

Full-body Motion Planning and Control for The Car Egress Task of the DARPA Robotics Challenge Full-body Motion Planning and Control for The Car Egress Task of the DARPA Robotics Challenge Chenggang Liu 1, Christopher G. Atkeson 1, Siyuan Feng 1, and X Xinjilefu 1 Abstract We present a motion planning

More information

Physically Based Character Animation

Physically Based Character Animation 15-464/15-664 Technical Animation April 2, 2013 Physically Based Character Animation Katsu Yamane Disney Research, Pittsburgh kyamane@disneyresearch.com Physically Based Character Animation Use physics

More information

Research on time optimal trajectory planning of 7-DOF manipulator based on genetic algorithm

Research on time optimal trajectory planning of 7-DOF manipulator based on genetic algorithm Acta Technica 61, No. 4A/2016, 189 200 c 2017 Institute of Thermomechanics CAS, v.v.i. Research on time optimal trajectory planning of 7-DOF manipulator based on genetic algorithm Jianrong Bu 1, Junyan

More information

Dynamic State Estimation using Quadratic Programming

Dynamic State Estimation using Quadratic Programming 214 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS 214) September 14-18, 214, Chicago, IL, USA Dynamic State Estimation using Quadratic Programming X Xinjilefu, Siyuan Feng and

More information

Manipulator trajectory planning

Manipulator trajectory planning Manipulator trajectory planning Václav Hlaváč Czech Technical University in Prague Faculty of Electrical Engineering Department of Cybernetics Czech Republic http://cmp.felk.cvut.cz/~hlavac Courtesy to

More information

Jane Li. Assistant Professor Mechanical Engineering Department, Robotic Engineering Program Worcester Polytechnic Institute

Jane Li. Assistant Professor Mechanical Engineering Department, Robotic Engineering Program Worcester Polytechnic Institute Jane Li Assistant Professor Mechanical Engineering Department, Robotic Engineering Program Worcester Polytechnic Institute (3 pts) Compare the testing methods for testing path segment and finding first

More information

Motion Synthesis and Editing. Yisheng Chen

Motion Synthesis and Editing. Yisheng Chen Motion Synthesis and Editing Yisheng Chen Overview Data driven motion synthesis automatically generate motion from a motion capture database, offline or interactive User inputs Large, high-dimensional

More information

Modeling Physically Simulated Characters with Motion Networks

Modeling Physically Simulated Characters with Motion Networks In Proceedings of Motion In Games (MIG), Rennes, France, 2012 Modeling Physically Simulated Characters with Motion Networks Robert Backman and Marcelo Kallmann University of California Merced Abstract.

More information

Research Subject. Dynamics Computation and Behavior Capture of Human Figures (Nakamura Group)

Research Subject. Dynamics Computation and Behavior Capture of Human Figures (Nakamura Group) Research Subject Dynamics Computation and Behavior Capture of Human Figures (Nakamura Group) (1) Goal and summary Introduction Humanoid has less actuators than its movable degrees of freedom (DOF) which

More information

Last Time? Animation, Motion Capture, & Inverse Kinematics. Today. Keyframing. Physically-Based Animation. Procedural Animation

Last Time? Animation, Motion Capture, & Inverse Kinematics. Today. Keyframing. Physically-Based Animation. Procedural Animation Last Time? Animation, Motion Capture, & Inverse Kinematics Navier-Stokes Equations Conservation of Momentum & Mass Incompressible Flow Today How do we animate? Keyframing Procedural Animation Physically-Based

More information

Homework 2 Questions? Animation, Motion Capture, & Inverse Kinematics. Velocity Interpolation. Handing Free Surface with MAC

Homework 2 Questions? Animation, Motion Capture, & Inverse Kinematics. Velocity Interpolation. Handing Free Surface with MAC Homework 2 Questions? Animation, Motion Capture, & Inverse Kinematics Velocity Interpolation Original image from Foster & Metaxas, 1996 In 2D: For each axis, find the 4 closest face velocity samples: Self-intersecting

More information

Control of industrial robots. Kinematic redundancy

Control of industrial robots. Kinematic redundancy Control of industrial robots Kinematic redundancy Prof. Paolo Rocco (paolo.rocco@polimi.it) Politecnico di Milano Dipartimento di Elettronica, Informazione e Bioingegneria Kinematic redundancy Direct kinematics

More information

Last Time? Animation, Motion Capture, & Inverse Kinematics. Today. Keyframing. Physically-Based Animation. Procedural Animation

Last Time? Animation, Motion Capture, & Inverse Kinematics. Today. Keyframing. Physically-Based Animation. Procedural Animation Last Time? Animation, Motion Capture, & Inverse Kinematics Navier-Stokes Equations Conservation of Momentum & Mass Incompressible Flow Today How do we animate? Keyframing Procedural Animation Physically-Based

More information

Table of Contents. Chapter 1. Modeling and Identification of Serial Robots... 1 Wisama KHALIL and Etienne DOMBRE

Table of Contents. Chapter 1. Modeling and Identification of Serial Robots... 1 Wisama KHALIL and Etienne DOMBRE Chapter 1. Modeling and Identification of Serial Robots.... 1 Wisama KHALIL and Etienne DOMBRE 1.1. Introduction... 1 1.2. Geometric modeling... 2 1.2.1. Geometric description... 2 1.2.2. Direct geometric

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

Tight Coupling between Manipulation and Perception using SLAM

Tight Coupling between Manipulation and Perception using SLAM Tight Coupling between Manipulation and Perception using SLAM Benzun Pious Wisely Babu Christopher Bove Michael A. Gennert Robotics Engineering Department Worcester Polytechnic Institute Worcester, MA

More information

Trajectory Optimization

Trajectory Optimization Trajectory Optimization Jane Li Assistant Professor Mechanical Engineering & Robotics Engineering http://users.wpi.edu/~zli11 Recap We heard about RRT*, a sampling-based planning in high-dimensional cost

More information

Operation Trajectory Control of Industrial Robots Based on Motion Simulation

Operation Trajectory Control of Industrial Robots Based on Motion Simulation Operation Trajectory Control of Industrial Robots Based on Motion Simulation Chengyi Xu 1,2, Ying Liu 1,*, Enzhang Jiao 1, Jian Cao 2, Yi Xiao 2 1 College of Mechanical and Electronic Engineering, Nanjing

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

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

Last Time? Inverse Kinematics. Today. Keyframing. Physically-Based Animation. Procedural Animation

Last Time? Inverse Kinematics. Today. Keyframing. Physically-Based Animation. Procedural Animation Last Time? Inverse Kinematics Navier-Stokes Equations Conservation of Momentum & Mass Incompressible Flow Today How do we animate? Keyframing Procedural Animation Physically-Based Animation Forward and

More information

Standing Balance Control Using a Trajectory Library

Standing Balance Control Using a Trajectory Library The 29 IEEE/RSJ International Conference on Intelligent Robots and Systems October 11-15, 29 St. Louis, USA Standing Balance Control Using a Trajectory Library Chenggang Liu and Christopher G. Atkeson

More information

Approximate Policy Transfer applied to Simulated. Bongo Board balance toy

Approximate Policy Transfer applied to Simulated. Bongo Board balance toy Approximate Policy Transfer applied to Simulated Bongo Board Balance Stuart O. Anderson, Jessica K. Hodgins, Christopher G. Atkeson Robotics Institute Carnegie Mellon University soa,jkh,cga@ri.cmu.edu

More information

Simultaneous Tracking and Balancing of Humanoid Robots for Imitating Human Motion Capture Data

Simultaneous Tracking and Balancing of Humanoid Robots for Imitating Human Motion Capture Data The 2009 IEEE/RSJ International Conference on Intelligent Robots and Systems October 11-15, 2009 St. Louis, USA Simultaneous Tracking and Balancing of Humanoid Robots for Imitating Human Motion Capture

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

An Efficient Method for Solving the Direct Kinematics of Parallel Manipulators Following a Trajectory

An Efficient Method for Solving the Direct Kinematics of Parallel Manipulators Following a Trajectory An Efficient Method for Solving the Direct Kinematics of Parallel Manipulators Following a Trajectory Roshdy Foaad Abo-Shanab Kafr Elsheikh University/Department of Mechanical Engineering, Kafr Elsheikh,

More information

Online Gain Switching Algorithm for Joint Position Control of a Hydraulic Humanoid Robot

Online Gain Switching Algorithm for Joint Position Control of a Hydraulic Humanoid Robot Online Gain Switching Algorithm for Joint Position Control of a Hydraulic Humanoid Robot Jung-Yup Kim *, Christopher G. Atkeson *, Jessica K. Hodgins *, Darrin C. Bentivegna *,** and Sung Ju Cho * * Robotics

More information

Redundancy Resolution by Minimization of Joint Disturbance Torque for Independent Joint Controlled Kinematically Redundant Manipulators

Redundancy Resolution by Minimization of Joint Disturbance Torque for Independent Joint Controlled Kinematically Redundant Manipulators 56 ICASE :The Institute ofcontrol,automation and Systems Engineering,KOREA Vol.,No.1,March,000 Redundancy Resolution by Minimization of Joint Disturbance Torque for Independent Joint Controlled Kinematically

More information

Optimal motion trajectories. Physically based motion transformation. Realistic character animation with control. Highly dynamic motion

Optimal motion trajectories. Physically based motion transformation. Realistic character animation with control. Highly dynamic motion Realistic character animation with control Optimal motion trajectories Physically based motion transformation, Popovi! and Witkin Synthesis of complex dynamic character motion from simple animation, Liu

More information

Human Motion Reconstruction by Direct Control of Marker Trajectories

Human Motion Reconstruction by Direct Control of Marker Trajectories Human Motion Reconstruction by Direct Control of Marker Trajectories Emel Demircan, Luis Sentis, Vincent De Sapio and Oussama Khatib Artificial Intelligence Laboratory, Stanford University, Stanford, CA

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

Animation Lecture 10 Slide Fall 2003

Animation Lecture 10 Slide Fall 2003 Animation Lecture 10 Slide 1 6.837 Fall 2003 Conventional Animation Draw each frame of the animation great control tedious Reduce burden with cel animation layer keyframe inbetween cel panoramas (Disney

More information

Optimal Joint Trajectory Planning for Manipulator Robot Performing Constrained Motion Tasks

Optimal Joint Trajectory Planning for Manipulator Robot Performing Constrained Motion Tasks Optimal Joint Trajectory Planning for Manipulator Robot Performing Constrained Motion Tasks Yueshi Shen Department of Information Engineering Australian National University Canberra ACT 0200, Australia

More information

Smooth Transition Between Tasks on a Kinematic Control Level: Application to Self Collision Avoidance for Two Kuka LWR Robots

Smooth Transition Between Tasks on a Kinematic Control Level: Application to Self Collision Avoidance for Two Kuka LWR Robots Smooth Transition Between Tasks on a Kinematic Control Level: Application to Self Collision Avoidance for Two Kuka LWR Robots Tadej Petrič and Leon Žlajpah Abstract A common approach for kinematically

More information

Intermediate Desired Value Approach for Continuous Transition among Multiple Tasks of Robots

Intermediate Desired Value Approach for Continuous Transition among Multiple Tasks of Robots 2 IEEE International Conference on Robotics and Automation Shanghai International Conference Center May 9-3, 2, Shanghai, China Intermediate Desired Value Approach for Continuous Transition among Multiple

More information

Using Artificial Neural Networks for Prediction Of Dynamic Human Motion

Using Artificial Neural Networks for Prediction Of Dynamic Human Motion ABSTRACT Using Artificial Neural Networks for Prediction Of Dynamic Human Motion Researchers in robotics and other human-related fields have been studying human motion behaviors to understand and mimic

More information

Open Access The Kinematics Analysis and Configuration Optimize of Quadruped Robot. Jinrong Zhang *, Chenxi Wang and Jianhua Zhang

Open Access The Kinematics Analysis and Configuration Optimize of Quadruped Robot. Jinrong Zhang *, Chenxi Wang and Jianhua Zhang Send Orders for Reprints to reprints@benthamscience.ae The Open Automation and Control Systems Journal, 014, 6, 1685-1690 1685 Open Access The Kinematics Analysis and Configuration Optimize of Quadruped

More information

Abstract. 1 Introduction. 2 Concept of the mobile experimental

Abstract. 1 Introduction. 2 Concept of the mobile experimental ISR / ROBOTIK 2010 Mobile Experimental Platform for the Development of Environmentally Interactive Control Algorithms towards the Implementation on a Walking Humanoid Robot Giulio Milighetti, Janko Petereit

More information

Inverse Kinematics. Given a desired position (p) & orientation (R) of the end-effector

Inverse Kinematics. Given a desired position (p) & orientation (R) of the end-effector Inverse Kinematics Given a desired position (p) & orientation (R) of the end-effector q ( q, q, q ) 1 2 n Find the joint variables which can bring the robot the desired configuration z y x 1 The Inverse

More information

Animating Non-Human Characters using Human Motion Capture Data

Animating Non-Human Characters using Human Motion Capture Data Animating Non-Human Characters using Human Motion Capture Data Laurel Bancroft 1 and Jessica Hodgins 2 1 College of Fine Arts, Carngie Mellon University, lbancrof@andrew.cmu.edu 2 Computer Science, Carnegie

More information

This week. CENG 732 Computer Animation. Warping an Object. Warping an Object. 2D Grid Deformation. Warping an Object.

This week. CENG 732 Computer Animation. Warping an Object. Warping an Object. 2D Grid Deformation. Warping an Object. CENG 732 Computer Animation Spring 2006-2007 Week 4 Shape Deformation Animating Articulated Structures: Forward Kinematics/Inverse Kinematics This week Shape Deformation FFD: Free Form Deformation Hierarchical

More information

Inverse KKT Motion Optimization: A Newton Method to Efficiently Extract Task Spaces and Cost Parameters from Demonstrations

Inverse KKT Motion Optimization: A Newton Method to Efficiently Extract Task Spaces and Cost Parameters from Demonstrations Inverse KKT Motion Optimization: A Newton Method to Efficiently Extract Task Spaces and Cost Parameters from Demonstrations Peter Englert Machine Learning and Robotics Lab Universität Stuttgart Germany

More information

Mithras3D Team Description Paper 2014 Soccer Simulation 3D League

Mithras3D Team Description Paper 2014 Soccer Simulation 3D League Mithras3D Team Description Paper 2014 Soccer Simulation 3D League Armita Sabeti Ashraf, Atieh Alsadat Moosavian, Fatemeh Gerami Gohar, Fatima Tafazzoli Shadpour, Romina Moradi, Sama Moayeri Farzanegan

More information

Constrained Dynamic Parameter Estimation using the Extended Kalman Filter

Constrained Dynamic Parameter Estimation using the Extended Kalman Filter 15 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS) Congress Center Hamburg Sept 8 - Oct, 15. Hamburg, Germany Constrained Dynamic Parameter Estimation using the Extended Kalman

More information

Dynamic Analysis of Manipulator Arm for 6-legged Robot

Dynamic Analysis of Manipulator Arm for 6-legged Robot American Journal of Mechanical Engineering, 2013, Vol. 1, No. 7, 365-369 Available online at http://pubs.sciepub.com/ajme/1/7/42 Science and Education Publishing DOI:10.12691/ajme-1-7-42 Dynamic Analysis

More information

arxiv: v2 [cs.ro] 29 Jul 2016

arxiv: v2 [cs.ro] 29 Jul 2016 Scaling Sampling based Motion Planning to Humanoid Robots Yiming Yang, Vladimir Ivan, Wolfgang Merkt, Sethu Vijayakumar arxiv:1607.07470v2 [cs.ro] 29 Jul 2016 Abstract Planning balanced and collision free

More information

Sit-to-Stand Task on a Humanoid Robot from Human Demonstration

Sit-to-Stand Task on a Humanoid Robot from Human Demonstration 2010 IEEE-RAS International Conference on Humanoid Robots Nashville, TN, USA, December 6-8, 2010 Sit-to-Stand Task on a Humanoid Robot from Human Demonstration Michael Mistry, Akihiko Murai, Katsu Yamane,

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

Properties of Hyper-Redundant Manipulators

Properties of Hyper-Redundant Manipulators Properties of Hyper-Redundant Manipulators A hyper-redundant manipulator has unconventional features such as the ability to enter a narrow space while avoiding obstacles. Thus, it is suitable for applications:

More information

Simple feedforward control for responsive motion capture-driven simulations

Simple feedforward control for responsive motion capture-driven simulations Simple feedforward control for responsive motion capture-driven simulations Rubens F. Nunes 1,2, Creto A. Vidal 1, Joaquim B. Cavalcante-Neto 1, and Victor B. Zordan 2 1 CRAb Federal University of Ceará,

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

Serial Manipulator Statics. Robotics. Serial Manipulator Statics. Vladimír Smutný

Serial Manipulator Statics. Robotics. Serial Manipulator Statics. Vladimír Smutný Serial Manipulator Statics Robotics Serial Manipulator Statics Vladimír Smutný Center for Machine Perception Czech Institute for Informatics, Robotics, and Cybernetics (CIIRC) Czech Technical University

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

Modeling of Humanoid Systems Using Deductive Approach

Modeling of Humanoid Systems Using Deductive Approach INFOTEH-JAHORINA Vol. 12, March 2013. Modeling of Humanoid Systems Using Deductive Approach Miloš D Jovanović Robotics laboratory Mihailo Pupin Institute Belgrade, Serbia milos.jovanovic@pupin.rs Veljko

More information

VIBRATION ISOLATION USING A MULTI-AXIS ROBOTIC PLATFORM G.

VIBRATION ISOLATION USING A MULTI-AXIS ROBOTIC PLATFORM G. VIBRATION ISOLATION USING A MULTI-AXIS ROBOTIC PLATFORM G. Satheesh Kumar, Y. G. Srinivasa and T. Nagarajan Precision Engineering and Instrumentation Laboratory Department of Mechanical Engineering Indian

More information

1724. Mobile manipulators collision-free trajectory planning with regard to end-effector vibrations elimination

1724. Mobile manipulators collision-free trajectory planning with regard to end-effector vibrations elimination 1724. Mobile manipulators collision-free trajectory planning with regard to end-effector vibrations elimination Iwona Pajak 1, Grzegorz Pajak 2 University of Zielona Gora, Faculty of Mechanical Engineering,

More information

Modeling and kinematics simulation of freestyle skiing robot

Modeling and kinematics simulation of freestyle skiing robot Acta Technica 62 No. 3A/2017, 321 334 c 2017 Institute of Thermomechanics CAS, v.v.i. Modeling and kinematics simulation of freestyle skiing robot Xiaohua Wu 1,3, Jian Yi 2 Abstract. Freestyle skiing robot

More information

Keehoon Kim, Wan Kyun Chung, and M. Cenk Çavuşoğlu. 1 Jacobian of the master device, J m : q m R m ẋ m R r, and

Keehoon Kim, Wan Kyun Chung, and M. Cenk Çavuşoğlu. 1 Jacobian of the master device, J m : q m R m ẋ m R r, and 1 IEEE International Conference on Robotics and Automation Anchorage Convention District May 3-8, 1, Anchorage, Alaska, USA Restriction Space Projection Method for Position Sensor Based Force Reflection

More information

Kinesthetic Teaching via Fast Marching Square

Kinesthetic Teaching via Fast Marching Square Kinesthetic Teaching via Fast Marching Square Javier V. Gómez, David Álvarez, Santiago Garrido and Luis Moreno Abstract This paper presents a novel robotic learning technique based on Fast Marching Square

More information

Imitation Learning of Robot Movement Using Evolutionary Algorithm

Imitation Learning of Robot Movement Using Evolutionary Algorithm Proceedings of the 17th World Congress The International Federation of Automatic Control Imitation Learning of Robot Movement Using Evolutionary Algorithm GaLam Park, Syungkwon Ra ChangHwan Kim JaeBok

More information

Key-Words: - seven-link human biped model, Lagrange s Equation, computed torque control

Key-Words: - seven-link human biped model, Lagrange s Equation, computed torque control Motion Control of Human Bipedal Model in Sagittal Plane NURFARAHIN ONN, MOHAMED HUSSEIN, COLLIN HOWE HING TANG, MOHD ZARHAMDY MD ZAIN, MAZIAH MOHAMAD and WEI YING LAI Faculty of Mechanical Engineering

More information

1. Introduction 1 2. Mathematical Representation of Robots

1. Introduction 1 2. Mathematical Representation of Robots 1. Introduction 1 1.1 Introduction 1 1.2 Brief History 1 1.3 Types of Robots 7 1.4 Technology of Robots 9 1.5 Basic Principles in Robotics 12 1.6 Notation 15 1.7 Symbolic Computation and Numerical Analysis

More information

Animation, Motion Capture, & Inverse Kinematics

Animation, Motion Capture, & Inverse Kinematics Animation, Motion Capture, & Inverse Kinematics Pop Worksheet! Teams of 2. SOMEONE YOU HAVEN T ALREADY WORKED WITH Enumerate all cases (including rotations) of the 2D version of Marching Cubes, labeling

More information

CS 4620 Program #2: Character Animation

CS 4620 Program #2: Character Animation Cornell University CS 4620 Program #2: Character Animation Forward and Inverse Kinematics out: Tuesday 28 September 2010 due: Tuesday 19 October 2010 Author: Prof. Doug James In this second programming

More information

UNIVERSITY OF OSLO. Faculty of Mathematics and Natural Sciences

UNIVERSITY OF OSLO. Faculty of Mathematics and Natural Sciences Page 1 UNIVERSITY OF OSLO Faculty of Mathematics and Natural Sciences Exam in INF3480 Introduction to Robotics Day of exam: May 31 st 2010 Exam hours: 3 hours This examination paper consists of 5 page(s).

More information

Pose Control in Dynamic Conditions

Pose Control in Dynamic Conditions Pose Control in Dynamic Conditions Brian F. Allen 1, Michael Neff 2, and Petros Faloutsos 1 1 University of California, Los Angeles 2 University of California, Davis Abstract. Pose control for physically

More information

Human motion control with physically plausible foot contact models

Human motion control with physically plausible foot contact models Vis Comput (2015) 31:883 891 DOI 10.1007/s00371-015-1097-8 ORIGINAL ARTICLE Human motion control with physically plausible foot contact models Jongmin Kim 1 Hwangpil Park 2 Jehee Lee 2 Taesoo Kwon 1 Published

More information

Comparative Experiments on Task Space Control with Redundancy Resolution

Comparative Experiments on Task Space Control with Redundancy Resolution Comparative Experiments on Task Space Control with Redundancy Resolution Jun Nakanishi,RickCory, Michael Mistry,JanPeters, and Stefan Schaal ICORP, Japan Science and Technology Agency, Kyoto, Japan ATR

More information

Controlling Reactive, Motion Capture-driven Simulated Characters

Controlling Reactive, Motion Capture-driven Simulated Characters Controlling Reactive, Motion Capture-driven Simulated Characters Victor B. Zordan University of California at Riverside Motion capture-driven simulations? Motivation: Unreal Havok Havok2 Motion capture

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

Dynamically Balanced and Plausible Trajectory Planning for Human-Like Characters

Dynamically Balanced and Plausible Trajectory Planning for Human-Like Characters Dynamically Balanced and Plausible Trajectory Planning for Human-Like Characters Chonhyon Park, Jae Sung Park, Steve Tonneau, Nicolas Mansard, Franck Multon, Julien Pettré, and Dinesh Manocha UNC Chapel

More information

IK MAP: An Enhanced Workspace Representation to Support Inverse Kinematics Solvers

IK MAP: An Enhanced Workspace Representation to Support Inverse Kinematics Solvers IK MAP: An Enhanced Workspace Representation to Support Inverse Kinematics Solvers Nikolaus Vahrenkamp, Dominik Muth, Peter Kaiser, and Tamim Asfour Abstract We present an approach to improve the performance

More information

Practical Kinematic and Dynamic Calibration Methods for Force-Controlled Humanoid Robots

Practical Kinematic and Dynamic Calibration Methods for Force-Controlled Humanoid Robots 211 11th IEEE-RAS International Conference on Humanoid Robots Bled, Slovenia, October 26-28, 211 Practical Kinematic and Dynamic Calibration Methods for Force-Controlled Humanoid Robots Katsu Yamane Abstract

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

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

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

Policies for Goal Directed Multi-Finger Manipulation

Policies for Goal Directed Multi-Finger Manipulation Workshop on Virtual Reality Interaction and Physical Simulation VRIPHYS (2012) J. Bender, A. Kuijper, D. W. Fellner, and É. Guérin (Editors) Policies for Goal Directed Multi-Finger Manipulation S. Andrews

More information

Motion Capture & Simulation

Motion Capture & Simulation Motion Capture & Simulation Motion Capture Character Reconstructions Joint Angles Need 3 points to compute a rigid body coordinate frame 1 st point gives 3D translation, 2 nd point gives 2 angles, 3 rd

More information

Optimal Control Techniques for Dynamic Walking

Optimal Control Techniques for Dynamic Walking Optimal Control Techniques for Dynamic Walking Optimization in Robotics & Biomechanics IWR, University of Heidelberg Presentation partly based on slides by Sebastian Sager, Moritz Diehl and Peter Riede

More information

Simox: A Robotics Toolbox for Simulation, Motion and Grasp Planning

Simox: A Robotics Toolbox for Simulation, Motion and Grasp Planning Simox: A Robotics Toolbox for Simulation, Motion and Grasp Planning N. Vahrenkamp a,b, M. Kröhnert a, S. Ulbrich a, T. Asfour a, G. Metta b, R. Dillmann a, and G. Sandini b Abstract Simox is a C++ robotics

More information

Imitation Control for Biped Robot Using Wearable Motion Sensor

Imitation Control for Biped Robot Using Wearable Motion Sensor Imitation Control for Biped Robot Using Wearable Motion Sensor Tao Liu e-mail: liu.tao@kochi-tech.ac.jp Yoshio Inoue Kyoko Shibata Department of Intelligent Mechanical Systems Engineering, Kochi University

More information

Dynamic Simulation of Interactive Robotic Environment

Dynamic Simulation of Interactive Robotic Environment Dynamic Simulation of Interactive Robotic Environment Paul U. Lee, Diego C. Ruspini, and Oussama Khatib Robotics Laboratory Computer Science Department Stanford University, Stanford, CA 94305 Abstract

More information

Locally Weighted Learning

Locally Weighted Learning Locally Weighted Learning Peter Englert Department of Computer Science TU Darmstadt englert.peter@gmx.de Abstract Locally Weighted Learning is a class of function approximation techniques, where a prediction

More information

Direct Control of Simulated Non-human Characters

Direct Control of Simulated Non-human Characters IEEE COMPUTER GRAPHICS AND APPLICATIONS 1 Direct Control of Simulated Non-human Characters Junggon Kim and Nancy S. Pollard Carnegie Mellon University Abstract We present an intuitive technique to control

More information

ROBOTICS 01PEEQW. Basilio Bona DAUIN Politecnico di Torino

ROBOTICS 01PEEQW. Basilio Bona DAUIN Politecnico di Torino ROBOTICS 01PEEQW Basilio Bona DAUIN Politecnico di Torino Control Part 4 Other control strategies These slides are devoted to two advanced control approaches, namely Operational space control Interaction

More information

A Cost Oriented Humanoid Robot Motion Control System

A Cost Oriented Humanoid Robot Motion Control System Preprints of the 19th World Congress The International Federation of Automatic Control A Cost Oriented Humanoid Robot Motion Control System J. Baltes*, P. Kopacek**,M. Schörghuber** *Department of Computer

More information

SIMULATION ENVIRONMENT PROPOSAL, ANALYSIS AND CONTROL OF A STEWART PLATFORM MANIPULATOR

SIMULATION ENVIRONMENT PROPOSAL, ANALYSIS AND CONTROL OF A STEWART PLATFORM MANIPULATOR SIMULATION ENVIRONMENT PROPOSAL, ANALYSIS AND CONTROL OF A STEWART PLATFORM MANIPULATOR Fabian Andres Lara Molina, Joao Mauricio Rosario, Oscar Fernando Aviles Sanchez UNICAMP (DPM-FEM), Campinas-SP, Brazil,

More information

Simulation-Based Design of Robotic Systems

Simulation-Based Design of Robotic Systems Simulation-Based Design of Robotic Systems Shadi Mohammad Munshi* & Erik Van Voorthuysen School of Mechanical and Manufacturing Engineering, The University of New South Wales, Sydney, NSW 2052 shadimunshi@hotmail.com,

More information

Cecilia Laschi The BioRobotics Institute Scuola Superiore Sant Anna, Pisa

Cecilia Laschi The BioRobotics Institute Scuola Superiore Sant Anna, Pisa University of Pisa Master of Science in Computer Science Course of Robotics (ROB) A.Y. 2016/17 cecilia.laschi@santannapisa.it http://didawiki.cli.di.unipi.it/doku.php/magistraleinformatica/rob/start Robot

More information

1 Trajectories. Class Notes, Trajectory Planning, COMS4733. Figure 1: Robot control system.

1 Trajectories. Class Notes, Trajectory Planning, COMS4733. Figure 1: Robot control system. Class Notes, Trajectory Planning, COMS4733 Figure 1: Robot control system. 1 Trajectories Trajectories are characterized by a path which is a space curve of the end effector. We can parameterize this curve

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

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

A NOUVELLE MOTION STATE-FEEDBACK CONTROL SCHEME FOR RIGID ROBOTIC MANIPULATORS

A NOUVELLE MOTION STATE-FEEDBACK CONTROL SCHEME FOR RIGID ROBOTIC MANIPULATORS A NOUVELLE MOTION STATE-FEEDBACK CONTROL SCHEME FOR RIGID ROBOTIC MANIPULATORS Ahmad Manasra, 135037@ppu.edu.ps Department of Mechanical Engineering, Palestine Polytechnic University, Hebron, Palestine

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

Human Motion Synthesis by Motion Manifold Learning and Motion Primitive Segmentation

Human Motion Synthesis by Motion Manifold Learning and Motion Primitive Segmentation Human Motion Synthesis by Motion Manifold Learning and Motion Primitive Segmentation Chan-Su Lee and Ahmed Elgammal Rutgers University, Piscataway, NJ, USA {chansu, elgammal}@cs.rutgers.edu Abstract. We

More information

Lecture «Robot Dynamics»: Kinematics 3

Lecture «Robot Dynamics»: Kinematics 3 Lecture «Robot Dynamics»: Kinematics 3 151-0851-00 V lecture: CAB G11 Tuesday 10:15 12:00, every week exercise: HG E1.2 Wednesday 8:15 10:00, according to schedule (about every 2nd week) office hour: LEE

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

Simulation. x i. x i+1. degrees of freedom equations of motion. Newtonian laws gravity. ground contact forces

Simulation. x i. x i+1. degrees of freedom equations of motion. Newtonian laws gravity. ground contact forces Dynamic Controllers Simulation x i Newtonian laws gravity ground contact forces x i+1. x degrees of freedom equations of motion Simulation + Control x i Newtonian laws gravity ground contact forces internal

More information