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

Size: px
Start display at page:

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

Transcription

1 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 via per Monteroni, 731 Lecce, Italy andrea.manni@unile.it, angelo.dinoi@unile.it and giovanni.indiveri@unile.it Abstract Given the intrinsic instability of walking humanoid robots, the design of controllers assuring robust stabilization of walking gaits is one of the most important goals. This paper describes a control architecture aiming at decoupling the problem of stable walking in the two relatively simpler problems of legs gait generation and upper body feedback control to guarantee dynamic stability. The upper body joints control law has the objective of stabilizing a proper dynamic stability index to a suitable reference value. Possible dynamic stability indexes include the ZMP (Zero Moment Point) or the FRI (Foot Rotation Index) points. As these points depend on joint accelerations and jerks that are not easily measured on a small size low cost platform, the presented implementation of the proposed architecture builds on the use of the GCoM point (Ground projection of the Center of Mass) that may be considered a suitable stability index only in quasi static robot states. The presented solution is particularly suited for small size robots having limited onboard computational power and limited sensor suits. The effectiveness of the proposed method has been validated through Matlab R simulations and experimental tests performed on a Robovie-MS VStone s platform. I. INTRODUCTION Interest in biped robots has rapidly increased over the last thirty years in view of developing robots capable of effectively moving in unstructured environments. In particular, anthropomorphic biped robots are potentially able to move in all the environments where humans do. In recent years, a number of humanoid robots capable of walking have been developed. These includes the Honda P3 and Asimo [1] or Sony Qrio [13], and Tokyo University s H6, whereas simpler designs include Vstone [18], Kondo [6] or RoboSapien [12], which has been developed for the toy market. Small humanoid robots can have from a few to over twenty actuated degrees of freedom and generally they carry some microcontroller electronics board for the low level control, i.e. to generate target signals for the actuators. The communication link between low and higher level control loops is most often of serial RS232 kind. The actuators are usually low power servo motors from the radio control (RC) models market. Biped locomotion is one of the most important issues to be faced. During walking, two different situations arise in sequence: the double support phase in which the mechanism is supported on both feet simultaneously, and the single support phase, when only one foot of the mechanism is in contact with the ground while the other is being transferred from the back to the front positions. Several methods have been presented in the literature to address the stability problem. Some of these are based on the inverted pendulum model for the biped legs [1], [14], [3]. Other techniques take directly into account dynamic stability indicators as the zero moment point (ZMP) [8], [7] or the foot rotation indicator (FRI) [4]. The ZMP was originally introduced by Vukobratović [17], [16] and is defined as the point in the ground plane about which the total moments due to the ground contacts become zero in the plane. The FRI, introduced by Goswami [5], is defined as the point on the foot/ground contact surface, within or outside the convex hull of the foot-support area, at which the resultant moment of the force/torque impressed on the foot is normal to the surface. Building on Lyapunov Theory based nonlinear control methods, in this paper we propose a control law for the upper body joints able to guarantee quasi static walking stability of a small size and low-cost humanoid robot. The presented control architecture allows to decouple the gait generation issue and the overall stability of the system. The analysis of stability is addressed on the basis of the Ground projection of the Center of Mass (GCoM) and the support polygon. The remainder of the paper is organized as follows: the proposed control method is derived in section II. Simulation and experimental results are presented in section III and, finally, conclusions are briefly discussed in section IV. II. CONTROL METHOD The general control architecture of the proposed method has been presented in [11] and it is shown in figure 1 for the sake of clarity. The basic idea is that the leg joints only are considered for locomotion planning while the upper body and arm joints are used for stabilization of the robot. This approach allows to decouple the gait generation and stabilization problems. Decoupling the gait planning and dynamic stabilization tasks is particularly important for small size robots that have limited computational power. In order for such decoupling to be effective, the cycle time of the stabilization controller needs to be suitably smaller than the gait period. Notice that this task division approach can be compared to [9] with the difference

2 Fig. 1. Control architecture. that in [9] the task division is implemented at an algorithmic level, while in the present case at a control architecture level. With reference to figure 1 q L, q L and q L are the acceleration, velocity and position, respectively, of the leg joints. Likewise q UB are the acceleration of the upper body joints, while q R and q R are the overall accelerations and positions, respectively, of the robot joints; v csp and r csp are the velocity and position of a target point in the ground plane to be used as reference value for a proper stability index as the ZMP, the FRI or the GCoM (Ground projection of the Center of Mass) that may be considered a suitable stability index only in quasi static robot states. Vectors q L and q UB are the estimates of the legs and upper body joint positions based upon the robots sensors; at last τ L and τ UB are the actuator leg torques and upper body torques. The gait generator block in figure 1 is a planner for the leg joints motions. The gait generator output is used to define the leg joint commands and it may use joint information also to perform obstacle avoidance planning or re-planning. As for the stability control, the direct kinematics model is used to compute the position of the center of the support polygon as a function of the joint values. The stabilization controller has as input the vector difference of the position of a target point inside the support polygon with the position of a proper stability index as the FRI (as reported in figure 1), the ZMP or the GCoM in quasi static cases. The control objective of this control system is to drive the above defined error to zero by acting on the upper body degrees of freedom only. A. Gait pattern generation In the literature the general issue of gait generation has been formulated in several ways including an optimization problem (eg. generation of energy optimal gait cycles), a path planning problem or a kinematics problem. In this work a kinematics approach is followed. After having derived the kinematics equations of the robots legs based upon Denavit-Hartenberg s convention, a point to point method [15] is used to generate joint trajectories. In order to generate a smooth motion, it is necessary that the boundary values of joint speeds and accelerations in the point to point time profile be all zero. To this extent a fifth order spline interpolation is used for each leg joint, namely q(t) = a 5 t 5 + a 4 t 4 + a 3 t 3 + a 2 t 2 + a 1 t + a (1) where t t f ; the a j determined as: : j = 1,..., 5 parameters can be a = M 1 q where a = [a a 1 a 2 a 3 a 4 a 5 ] T is the parameter vector and q = [q i q f q i q f q i q f ] T defines the desired polynomial boundary conditions. Matrix M R 6 6 is known by construction, and in particular, 1 t i t 2 i t 3 i t 4 i t 5 i 1 t f t 2 f t 3 f t 4 f t 5 f M = 1 2t i 3t 2 i 4t 3 i 5t 4 i 1 2t f 3t 2 f 4t 3 f 5t 4 f 2 6t i 12t 2 i t 3 i 2 6t f 12t 2 f t 3 f where q i = initial position, q f = final position t i = initial time, t f = final time q i =, q f =, q i =, q f =, t f > t i B. Implementation issues The stabilization feedback control loop described in figure 1 can be designed based upon a Lyapunov technique. Wanting the GCoM point to converge on a target point r t within the support polygon, a quadratic Lyapunov candidate function may be defined as: V = 1 2 (r t r GCoM ) T R (r t r GCoM ) (2) where R will be a symmetric positive defined matrix, and r t and r GCoM are the positions of a target point inside the support polygon and of the GCoM respectively. The time derivative of V will be given by: ) T ) V = (ṙ GCoM ṙ t R (r t r GCoM (3)

3 Fig. 3. Robot model in sagittal plane Calling q L, q UB the legs and upper body joint variables and J L (q), J UB (q) the legs and upper body Jacobian matrices such that ṙ GCoM = J L (q) q L + J UB (q) q UB, (4) equation (3) suggests to compute the reference value of the upper joint velocities as [ ] q UBd = J UB R (r t r GCoM ) J L q L + ṙ t (5) being J UB the weighted pseudo-inverse of matrix J UB. In case J UB should be full rank, J UB results in J ( ) UB = W 1 JUB T JUB W 1 JUB T 1 for some symmetric positive definite W of proper dimension. In case J UB should be rank deficient in some pose, J UB could be calculated on the basis of a singular value decomposition. Alternatively J UB could be taken to be a damped least squares inverse [15], hence avoiding singularity issues at the expense of control accuracy. Assuming J UB = W ( ) 1, 1 JUB T JUB W 1 JUB T the extra degrees of freedom provided by the entries of the positive definite weight matrix W can be eventually dynamically assigned in order to try avoiding link collisions and kinematics singularities. As for the q L, q L and ṙ t in the upper body joint control law (5), notice that q L and q L are known as they are generated by the legs gait controller and ṙ t is generated in such a way that r t is always within the support polygon. Generally ṙ t is designed such that during the single support phase r t moves within the support polygon in the same direction of the walking gait so that at the end of the single support phase, when the support polygon becomes the one of the double support phase, r t will be located approximately in its center. Considering only the sagittal plane, for the sake of simplicity, the robot model is represented in fig. 3. In this case the Jacobian matrices are reported in ( fig. 2 where M is the total mass of the robot and k 1 r m1 ) ( m 2 + m 3 + m 4 + m 5 + m 6 + m 7, k2 r m m ) ( 3 + m 4 + m 5 + m 6 + m 7, k 3 r m m ) ( 6 + m 7, k4 r m m ) 5, m k5 r 5 5 2, m k 6 r 6 6 2, k m 7 r and m i and r i are respectively the mass and the length of the i-th link as reported in Table I. III. SIMULATION AND EXPERIMENTAL RESULTS The presented control approach has been validated in the sagittal plane both in simulation and experimentally. The simulations have been performed in Matlab using the Robotics Toolbox realized by P. I. Corke [2]. The experimental implementation has been realized using the Robovie-MS VStone s platform. In figure 5 simulation results are displayed relative to a case where the robot starts from a double support phase: the right foot is moved upwards giving rise to a single support (on the left foot) phase during which the left knee is bend contributing to move the GCoM in the negative x direction. The target point to be used as reference for the GCoM is located at the center of the support polygon and it is assumed to have identically zero velocity. As expected, figure (5 (a)) shows that the error r t r GCoM is driven to zero by the action of the upper body joints (torso and arms). The parameters used for simulations are reported in Table I. In figures (5 (b)-(c)) the values of the upper body joints θ 3, θ 6, θ 7 and their velocities are reported. Panel (d) shows a stick diagram of the robot movement. In this simulation matrix W was the identity. In figure 6 simulation results are displayed relative to the same leg motion of the previous case, but with a different W matrix, namely: 1 W = 1 (6) 1 As expected, the torso moves less than in the previous simulation and GCoM error is driven to zero by the major action of arms joints. At last in figure 7 simulation results are displayed without upper body joints control, namely the upper body joints are kept still in their initial values, the same used in the previous cases. As expected the x coordinate of GCoM leaves the support polygon resulting in the loss of stability (i.e. the robot would fall). N Link Length (cm) Mass (g) 1 9, , , , , , , TABLE I ROBOVIE-MS PARAMETERS USED FOR THE SIMULATIONS. The robot used for the experimental validation is shown in figure 4. It is a Robovie-MS made by Vstone [18]. The robot has 17 degrees of freedom (DOFs): 5 in each leg, 3 in each arm and one in the head. It is 28 cm tall and has a total weight of about 86g. It has one 2 axis acceleration sensor and 17 joint angle sensors. The servos control board is composed by an H8 CPU at MHz, a 56KByte FLASH- ROM memory, a 4KByte RAM and a 128KByte External- EEPROM. Experimental results relative to the implementation of the proposed control law for the sagittal plane are reported in figure (8). Notice that, during the experimental validation tests, the robot needs to perform a dorsal plane movement (figure (8) (d)) to prevent the GCoM point from falling

4 J L (q)= 1 M 2 64 k 1 s 1 k 2 s 12 k 3 s 123 +k 4 s 1234 k 5 s k 6 s 1236 k 7 s 1237 k 2 s 12 k 3 s 123 +k 4 s 1234 k 5 s k 6 s 1236 k 7 s 1237 k 4 s 1234 k 5 s k 5 s k 1 c 1 +k 2 c 12 +k 3 c 123 k 4 c k 5 c k 6 c k 7 c 1237 k 2 c 12 +k 3 c 123 k 4 c k 5 c k 6 c k 7 c 1237 k 4 c k 5 c k 5 c k 3 s 123 +k 4 s 1234 k 5 s k 6 s 1236 k 7 s 1237 k 6 s 1236 k 7 s J UB (q)= 1 M 64 k 3 c 123 k 4 c k 5 c k 6 c k 7 c 1237 k 6 c 1236 k 7 c Fig. 2. Jacobian matrices to calculate ṙ GCoM. The notations s i...j, c i...j represent, respectively, sin(q i q j ), cos(q i q j ) fall in case the upper body joints were kept still did not cause the robot to fall when the upper body joints were controlled according to the presented strategy. Simulations performed at higher update frequencies and higher link velocities confirm the effectiveness of the presented solution. Near future work will focus on the implementation of this architecture using dynamic stability indexes as the ZMP or FRI that depend on the joint accelerations and jerks that are not easily available on low cost platforms. REFERENCES Fig. 4. Robovie-MS out of the single support phase support polygon in the z direction. Such dorsal plane motion is commanded in open loop. Moreover, as the joints are actuated by position servo motors, the control law (5) has been integrated in order to compute position commands for the upper body joints. Given the limited communication bandwidth with the joint position servo controllers, during the experimental tests the position commands (labeled as viapoints in figure (8)) were updated at very low frequency (approximately 1Hz). Nevertheless, as shown in figure (8), the sagittal plane component of the GCoM point converges to its target value. In particular, the experimental results reported in figure (8) refer to the same situation of simulations. Destabilizing x axis motion of the GCoM is automatically compensated for, in the sagittal plane, by the upper body joints controlled by the proposed law. Overall, the x coordinate of the GCoM converges to its constant target position approximately located at the center of the support polygon. IV. CONCLUSION A method to control the upper body joints of a humanoid robot in order to stabilize it, has been presented. This method allows to decouple the gait generation issue from the stabilization one. To the best of the author s knowledge, this approach appears to be novel. The proposed solution is particularly suited for small size, low cost humanoid systems having limited computational power. Although due to HW constraints the experimental validation was possible only at rather low control update frequencies (approximately 1Hz), extensive trials have shown that leg motions that would have caused the robot to [1] Honda (Inc), [2] P. I. Corke, A Robotics Toolbox for MATLAB, IEEE Robotics and Automation Magazine 3(1), pp [3] A. Goswami, B. Espiau and A. Keramane, Limit Cycles in a Passive Compass Gait Biped and Passivity-Mimicking Control Laws, Autonomous Robots, Vol. 4, pp , [4] A. Hoffman, M. Popovic, S. Massaquoi and H. Herr, A sliding controller for bipedal balancing using integrated movement of contact and noncontact limbs, in Proc. of the IEEE/RSJ International Conference on Intelligent Robots and System, (Sendal, Japan), 4. [5] A. Goswami, Postural Stability of Biped Robots and the Foot-Rotation Indicator (FRI) Point, The International Journal of Robotic Research, Vol. 18, No. 6, pp , [6] Kagaku (Co. Ltd), [7] R. Kurazume, T. Hasegawa and K. Yoneda, he Sway Compensation Trajectory for a Biped Robot, in Proc. of the 3 IEEE International Conference on Robotics and Automation, Taipei, Taiwan, 3. [8] S. Kajita, F. Kanehiro, K. Kaneko, K. Fujiwara, K. Harada, K. Yokoi and H. Hirukawa Biped Walking Pattern Generation by using Preview Control of Zero-Moment Point, in Proc. of the 3 IEEE/RSJ Internationa Conference on Robotics and Automation, Taipei, Taiwan, 3. [9] O. Khatib, L. Sentis, J. Park and J. Warren Whole-Body Dynamic Behavior And Control Of Human-Like Robots, International Journal of Humanoid Robotics, Vol. 1, No. 1, pp , 4. [1] T. Tsuji and K. Ohnishi, A control of biped robot which applies inverted pendulum mode with virtual supporting point, AMC 2, Maribor, Slovenia, 2. [11] A. Manni, A. di Noi and G. Indiveri, A control architecture for dynamically stable gaits of small size humanoid robots, in Proc. of the 8th International IFAC Symposium on Robot Control SYROCO 6, September 6-8, Bologna (Italy) 6. [12] Wowwee (Robosapien), [13] Sony (Global), [14] M. Srinivasan and A. Ruina, Computer optimization of a minimal biped model discovers walking and running, Nature Letters to Editor, 11 Sept. 5. [15] L. Sciavicco and B. Siciliano, Modelling and Control of Robot Manipulators, Springer, Berlin,. [16] M. Vukobratović and B. Borovac, Zero-Moment Point - Thirty five years of its life, International Journal of Humanoid Robotics, Vol. 1, No. 1, pp , 4. [17] M. Vukobratović and D. Juricic, Contribution to the synthesis of biped gait, IEEE Trans. Bio-Medical Engineering, Vol. 16, No. 1, pp. 1-6, [18] Vstone (Co. Ltd),

5 x coordinate of GCoM (cm) Upper body joints (deg) 4 θ 3 θ 6 θ x coordinate of Ground projection of Center of Mass (a) (b) 3 Upper body joint velocities (deg/s) y (cm) dθ 3 dθ 6 dθ (c) x (cm) (d) Fig. 5. Simulation 1: (a) position of the x coordinate of GCoM (solid line) and position of target point (dashed line); (b) θ 3, θ 6 and θ 7 position, (c) θ 3, θ 6 and θ 7 velocity, (d) stick diagram of start (solid line), middle (dashed line) and final (dotted line) configuration and position of the center of the support polygon ( (hidden under )) and the position of the center of mass ( ) θ 3 θ θ 7 x coordinate of GCoM (cm) Upper body joints (deg) x coordinate of Ground projection of Center of Mass (a) (b) 3 25 Upper body joint velocities (deg/s) y (cm) dθ 3 dθ 6 dθ (c) x (cm) (d) Fig. 6. Simulation 2: (a) position of the x coordinate of GCoM (solid line) and position of target point (dashed line); (b) θ 3, θ 6 and θ 7 position, (c) θ 3, θ 6 and θ 7 velocity, (d) stick diagram of start (solid line), middle (dashed line) and final (dotted line) configuration and position of the center of the support polygon ( (hidden under )) and the position of the center of mass ( )

6 8 x coordinate of GCoM (cm) x coordinate of Ground projection of Center of Mass Pos. Support Polygon y (cm) (a) x (cm) (b) Fig. 7. Simulation 3: (a) position of the x coordinate of GCoM (solid line) and position of target point (dashed line) and position of support polygon (dash-dot line); (b) stick diagram of start (solid line), middle (dashed line) and final (dotted line) configuration and position of the center of the support polygon ( ) and the position of the center of mass ( ) x coordinate of GCoM.7 Pos. CoM (cm) Viapoint Fig. 8. Experimental results 1: (a) position of the x coordinate of GCoM (*) and position of target point (dashed line); (b) Robovie-MS initial position, (c) Robovie-MS middle position, (d) Robovie-MS final position

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

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

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

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

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

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

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

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

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 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

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

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

Motion Planning for Dynamic Knotting of a Flexible Rope with a High-speed Robot Arm

Motion Planning for Dynamic Knotting of a Flexible Rope with a High-speed Robot Arm The 2010 IEEE/RSJ International Conference on Intelligent Robots and Systems October 18-22, 2010, Taipei, Taiwan Motion Planning for Dynamic Knotting of a Flexible Rope with a High-speed Robot Arm Yuji

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

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

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

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

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

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

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

1498. End-effector vibrations reduction in trajectory tracking for mobile manipulator

1498. End-effector vibrations reduction in trajectory tracking for mobile manipulator 1498. End-effector vibrations reduction in trajectory tracking for mobile manipulator G. Pajak University of Zielona Gora, Faculty of Mechanical Engineering, Zielona Góra, Poland E-mail: g.pajak@iizp.uz.zgora.pl

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

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

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

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

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

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

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

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

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

Dynamically Balanced Omnidirectional Humanoid Robot Locomotion. An Honors Paper for the Department of Computer Science. By Johannes Heide Strom

Dynamically Balanced Omnidirectional Humanoid Robot Locomotion. An Honors Paper for the Department of Computer Science. By Johannes Heide Strom Dynamically Balanced Omnidirectional Humanoid Robot Locomotion An Honors Paper for the Department of Computer Science By Johannes Heide Strom Bowdoin College, 2009 c 2009 Johannes Heide Strom Contents

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

Development of an optomechanical measurement system for dynamic stability analysis

Development of an optomechanical measurement system for dynamic stability analysis Development of an optomechanical measurement system for dynamic stability analysis Simone Pasinetti Dept. of Information Engineering (DII) University of Brescia Brescia, Italy simone.pasinetti@unibs.it

More information

Serially-Linked Parallel Leg Design for Biped Robots

Serially-Linked Parallel Leg Design for Biped Robots December 13-15, 24 Palmerston North, New ealand Serially-Linked Parallel Leg Design for Biped Robots hung Kwon, Jung H. oon, Je S. eon, and Jong H. Park Dept. of Precision Mechanical Engineering, School

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

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

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

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

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

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

Written exams of Robotics 2

Written exams of Robotics 2 Written exams of Robotics 2 http://www.diag.uniroma1.it/~deluca/rob2_en.html All materials are in English, unless indicated (oldies are in Year Date (mm.dd) Number of exercises Topics 2018 07.11 4 Inertia

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

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

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

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

Parallel Robots. Mechanics and Control H AMID D. TAG HI RAD. CRC Press. Taylor & Francis Group. Taylor & Francis Croup, Boca Raton London NewYoric

Parallel Robots. Mechanics and Control H AMID D. TAG HI RAD. CRC Press. Taylor & Francis Group. Taylor & Francis Croup, Boca Raton London NewYoric Parallel Robots Mechanics and Control H AMID D TAG HI RAD CRC Press Taylor & Francis Group Boca Raton London NewYoric CRC Press Is an Imprint of the Taylor & Francis Croup, an informs business Contents

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

Robotics I. March 27, 2018

Robotics I. March 27, 2018 Robotics I March 27, 28 Exercise Consider the 5-dof spatial robot in Fig., having the third and fifth joints of the prismatic type while the others are revolute. z O x Figure : A 5-dof robot, with a RRPRP

More information

NMT EE 589 & UNM ME 482/582 ROBOT ENGINEERING. Dr. Stephen Bruder NMT EE 589 & UNM ME 482/582

NMT EE 589 & UNM ME 482/582 ROBOT ENGINEERING. Dr. Stephen Bruder NMT EE 589 & UNM ME 482/582 ROBOT ENGINEERING Dr. Stephen Bruder Course Information Robot Engineering Classroom UNM: Woodward Hall room 147 NMT: Cramer 123 Schedule Tue/Thur 8:00 9:15am Office Hours UNM: After class 10am Email bruder@aptec.com

More information

A Model-Based Control Approach for Locomotion Control of Legged Robots

A Model-Based Control Approach for Locomotion Control of Legged Robots Biorobotics Laboratory A Model-Based Control Approach for Locomotion Control of Legged Robots Semester project Master Program: Robotics and Autonomous Systems Micro-Technique Department Student: Salman

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

Modeling the manipulator and flipper pose effects on tip over stability of a tracked mobile manipulator

Modeling the manipulator and flipper pose effects on tip over stability of a tracked mobile manipulator Modeling the manipulator and flipper pose effects on tip over stability of a tracked mobile manipulator Chioniso Dube Mobile Intelligent Autonomous Systems Council for Scientific and Industrial Research,

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

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

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

SYNTHESIS AND RAPID PROTOTYPING OF MOTION FOR A FOUR-LEGGED MAMMAL-STRUCTURED ROBOT

SYNTHESIS AND RAPID PROTOTYPING OF MOTION FOR A FOUR-LEGGED MAMMAL-STRUCTURED ROBOT SYNTHESIS AND RAPID PROTOTYPING OF MOTION FOR A FOUR-LEGGED MAMMAL-STRUCTURED ROBOT Macie Tronacki* Industrial Research Institute for Automation and Measurements, Warsaw, Poland Corresponding author (mtronacki@piap.pl)

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

Sound and fast footstep planning for humanoid robots

Sound and fast footstep planning for humanoid robots 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

More information

Control of Snake Like Robot for Locomotion and Manipulation

Control of Snake Like Robot for Locomotion and Manipulation Control of Snake Like Robot for Locomotion and Manipulation MYamakita 1,, Takeshi Yamada 1 and Kenta Tanaka 1 1 Tokyo Institute of Technology, -1-1 Ohokayama, Meguro-ku, Tokyo, Japan, yamakita@ctrltitechacjp

More information

Inverse Kinematics Analysis for Manipulator Robot With Wrist Offset Based On the Closed-Form Algorithm

Inverse Kinematics Analysis for Manipulator Robot With Wrist Offset Based On the Closed-Form Algorithm Inverse Kinematics Analysis for Manipulator Robot With Wrist Offset Based On the Closed-Form Algorithm Mohammed Z. Al-Faiz,MIEEE Computer Engineering Dept. Nahrain University Baghdad, Iraq Mohammed S.Saleh

More information

Neural Network model for a biped robot

Neural Network model for a biped robot Neural Network model for a biped robot Daniel Zaldívar 1,2, Erik Cuevas 1,2, Raúl Rojas 1. 1 Freie Universität Berlin, Institüt für Informatik, Takustr. 9, D-14195 Berlin, Germany {zaldivar, cuevas, rojas}@inf.fu-berlin.de

More information

Design and Optimization of the Thigh for an Exoskeleton based on Parallel Mechanism

Design and Optimization of the Thigh for an Exoskeleton based on Parallel Mechanism Design and Optimization of the Thigh for an Exoskeleton based on Parallel Mechanism Konstantin Kondak, Bhaskar Dasgupta, Günter Hommel Technische Universität Berlin, Institut für Technische Informatik

More information

Mobile Robots Locomotion

Mobile Robots Locomotion Mobile Robots Locomotion Institute for Software Technology 1 Course Outline 1. Introduction to Mobile Robots 2. Locomotion 3. Sensors 4. Localization 5. Environment Modelling 6. Reactive Navigation 2 Today

More information

Singularity Handling on Puma in Operational Space Formulation

Singularity Handling on Puma in Operational Space Formulation Singularity Handling on Puma in Operational Space Formulation Denny Oetomo, Marcelo Ang Jr. National University of Singapore Singapore d oetomo@yahoo.com mpeangh@nus.edu.sg Ser Yong Lim Gintic Institute

More information

Kinematics and dynamics analysis of micro-robot for surgical applications

Kinematics and dynamics analysis of micro-robot for surgical applications ISSN 1 746-7233, England, UK World Journal of Modelling and Simulation Vol. 5 (2009) No. 1, pp. 22-29 Kinematics and dynamics analysis of micro-robot for surgical applications Khaled Tawfik 1, Atef A.

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

EXPLOITING MOTION SYMMETRY IN CONTROL OF EXOSKELETON LIMBS

EXPLOITING MOTION SYMMETRY IN CONTROL OF EXOSKELETON LIMBS EXPLOITING MOTION SYMMETRY IN CONTROL OF EXOSKELETON LIMBS Christian Reinicke Institut für Technische Informatik und Mikroelektronik, Technische Universität Berlin Berlin, Germany email: reinicke@cs.tu-berlin.de

More information

Position and Orientation Control of Robot Manipulators Using Dual Quaternion Feedback

Position and Orientation Control of Robot Manipulators Using Dual Quaternion Feedback The 2010 IEEE/RSJ International Conference on Intelligent Robots and Systems October 18-22, 2010, Taipei, Taiwan Position and Orientation Control of Robot Manipulators Using Dual Quaternion Feedback Hoang-Lan

More information

Design and Stiffness Analysis of 12 DoF Poppy-inspired Humanoid

Design and Stiffness Analysis of 12 DoF Poppy-inspired Humanoid Design and Stiffness Analysis of 12 DoF Poppy-inspired Humanoid Dmitry Popov, Alexandr Klimchik and Ilya Afanasyev Institute of Robotics, Innopolis University, Universitetskaya Str. 1, Innopolis, Russia

More information

STUDY OF ZMP MEASUREMENT FOR BIPEDROBOT USING FSR SENSOR

STUDY OF ZMP MEASUREMENT FOR BIPEDROBOT USING FSR SENSOR STUDY OF ZMP MEASUREMENT FOR BIPEDROBOT USING FSR SENSOR Bong Gyou Shim, *Eung Hyuk Lee, **Hong Ki Min, Seung Hong Hong Department of Electronic Engineering, Inha University *Department of Electronic Engineering,

More information

MOTION TRAJECTORY PLANNING AND SIMULATION OF 6- DOF MANIPULATOR ARM ROBOT

MOTION TRAJECTORY PLANNING AND SIMULATION OF 6- DOF MANIPULATOR ARM ROBOT MOTION TRAJECTORY PLANNING AND SIMULATION OF 6- DOF MANIPULATOR ARM ROBOT Hongjun ZHU ABSTRACT:In order to better study the trajectory of robot motion, a motion trajectory planning and simulation based

More information

Force control of redundant industrial robots with an approach for singularity avoidance using extended task space formulation (ETSF)

Force control of redundant industrial robots with an approach for singularity avoidance using extended task space formulation (ETSF) Force control of redundant industrial robots with an approach for singularity avoidance using extended task space formulation (ETSF) MSc Audun Rønning Sanderud*, MSc Fredrik Reme**, Prof. Trygve Thomessen***

More information

Inverse Kinematics of Robot Manipulators with Multiple Moving Control Points

Inverse Kinematics of Robot Manipulators with Multiple Moving Control Points Inverse Kinematics of Robot Manipulators with Multiple Moving Control Points Agostino De Santis and Bruno Siciliano PRISMA Lab, Dipartimento di Informatica e Sistemistica, Università degli Studi di Napoli

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

Biologically Inspired Kinematic Synergies Provide a New Paradigm for Balance Control of Humanoid Robots

Biologically Inspired Kinematic Synergies Provide a New Paradigm for Balance Control of Humanoid Robots Biologically Inspired Kinematic Synergies Provide a New Paradigm for Balance Control of Humanoid Robots Helmut Hauser #1, Gerhard Neumann #2, Auke J. Ijspeert 3, Wolfgang Maass #4 # Institute for Theoretical

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

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

Adaptive Control of 4-DoF Robot manipulator

Adaptive Control of 4-DoF Robot manipulator Adaptive Control of 4-DoF Robot manipulator Pavel Mironchyk p.mironchyk@yahoo.com arxiv:151.55v1 [cs.sy] Jan 15 Abstract In experimental robotics, researchers may face uncertainties in parameters of a

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

REDUCED END-EFFECTOR MOTION AND DISCONTINUITY IN SINGULARITY HANDLING TECHNIQUES WITH WORKSPACE DIVISION

REDUCED END-EFFECTOR MOTION AND DISCONTINUITY IN SINGULARITY HANDLING TECHNIQUES WITH WORKSPACE DIVISION REDUCED END-EFFECTOR MOTION AND DISCONTINUITY IN SINGULARITY HANDLING TECHNIQUES WITH WORKSPACE DIVISION Denny Oetomo Singapore Institute of Manufacturing Technology Marcelo Ang Jr. Dept. of Mech. Engineering

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

Humanoid Robotics Modeling by Dynamic Fuzzy Neural Network

Humanoid Robotics Modeling by Dynamic Fuzzy Neural Network Proceedings of International Joint Conference on Neural Networks, Orlando, Florida, USA, August 1-17, 7 umanoid Robotics Modeling by Dynamic Fuzzy Neural Network Zhe Tang, Meng Joo Er, and Geok See Ng

More information

Motion Control of Wearable Walking Support System with Accelerometer Considering Swing Phase Support

Motion Control of Wearable Walking Support System with Accelerometer Considering Swing Phase Support Proceedings of the 17th IEEE International Symposium on Robot and Human Interactive Communication, Technische Universität München, Munich, Germany, August 1-3, Motion Control of Wearable Walking Support

More information

Fuzzy Control for Bipedal Robot Considering Energy Balance

Fuzzy Control for Bipedal Robot Considering Energy Balance Contemporary Engineering Sciences, Vol., 28, no. 39, 945-952 HIKARI Ltd, www.m-hikari.com https://doi.org/.2988/ces.28.837 Fuzzy Control for Bipedal Robot Considering Energy Balance Jhonattan Gordillo

More information

10/11/07 1. Motion Control (wheeled robots) Representing Robot Position ( ) ( ) [ ] T

10/11/07 1. Motion Control (wheeled robots) Representing Robot Position ( ) ( ) [ ] T 3 3 Motion Control (wheeled robots) Introduction: Mobile Robot Kinematics Requirements for Motion Control Kinematic / dynamic model of the robot Model of the interaction between the wheel and the ground

More information

CS 231. Control for articulate rigid-body dynamic simulation. Articulated rigid-body dynamics

CS 231. Control for articulate rigid-body dynamic simulation. Articulated rigid-body dynamics CS 231 Control for articulate rigid-body dynamic simulation Articulated rigid-body dynamics F = ma No control 1 No control Ragdoll effects, joint limits RT Speed: many sims at real-time rates on today

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

Matlab Simulator of a 6 DOF Stanford Manipulator and its Validation Using Analytical Method and Roboanalyzer

Matlab Simulator of a 6 DOF Stanford Manipulator and its Validation Using Analytical Method and Roboanalyzer Matlab Simulator of a 6 DOF Stanford Manipulator and its Validation Using Analytical Method and Roboanalyzer Maitreyi More 1, Rahul Abande 2, Ankita Dadas 3, Santosh Joshi 4 1, 2, 3 Department of Mechanical

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

Lecture «Robot Dynamics»: Kinematic Control

Lecture «Robot Dynamics»: Kinematic Control Lecture «Robot Dynamics»: Kinematic Control 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) Marco Hutter,

More information

Experimental study of Redundant Snake Robot Based on Kinematic Model

Experimental study of Redundant Snake Robot Based on Kinematic Model 2007 IEEE International Conference on Robotics and Automation Roma, Italy, 10-14 April 2007 ThD7.5 Experimental study of Redundant Snake Robot Based on Kinematic Model Motoyasu Tanaka and Fumitoshi Matsuno

More information

Real-time gait planner for human walking using a lower limb exoskeleton and its implementation on Exoped robot

Real-time gait planner for human walking using a lower limb exoskeleton and its implementation on Exoped robot > REPLACE THIS LINE WITH YOUR PAPER IDENTIFICATION NUMBER (DOUBLE-CLICK HERE TO EDIT) < 1 Real-time gait planner for human walking using a lower limb exoskeleton and its implementation on Exoped robot

More information

Control of Walking Robot by Inverse Dynamics of Link Mechanisms Using FEM

Control of Walking Robot by Inverse Dynamics of Link Mechanisms Using FEM Copyright c 2007 ICCES ICCES, vol.2, no.4, pp.131-136, 2007 Control of Walking Robot by Inverse Dynamics of Link Mechanisms Using FEM S. Okamoto 1 and H. Noguchi 2 Summary This paper presents a control

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

AC : ADAPTIVE ROBOT MANIPULATORS IN GLOBAL TECHNOLOGY

AC : ADAPTIVE ROBOT MANIPULATORS IN GLOBAL TECHNOLOGY AC 2009-130: ADAPTIVE ROBOT MANIPULATORS IN GLOBAL TECHNOLOGY Alireza Rahrooh, University of Central Florida Alireza Rahrooh is aprofessor of Electrical Engineering Technology at the University of Central

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

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

Visual Servoing Utilizing Zoom Mechanism

Visual Servoing Utilizing Zoom Mechanism IEEE Int. Conf. on Robotics and Automation 1995, pp.178 183, Nagoya, May. 12 16, 1995 1 Visual Servoing Utilizing Zoom Mechanism Koh HOSODA, Hitoshi MORIYAMA and Minoru ASADA Dept. of Mechanical Engineering

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