Online Learning of a Full Body Push Recovery Controller for Omnidirectional Walking

Size: px
Start display at page:

Download "Online Learning of a Full Body Push Recovery Controller for Omnidirectional Walking"

Transcription

1 th IEEE-RAS International Conference on Humanoi Robots Ble, Slovenia, October 26-28, 2011 Online Learning of a Full Boy Push Recovery Controller for Omniirectional Walking Seung-Joon Yi, Byoung-Tak Zhang, Dennis Hong an Daniel D. Lee Abstract Bipeal humanoi robots are inherently unstable to external perturbations, especially when they are walking on uneven terrain in the presence of unforeseen collisions. In this paper, we present a push recovery controller for position-controlle humanoi robots which is tightly integrate with an omniirectional walk controller. The high level push recovery controller learns to integrate three biomechanically motivate push recovery strategies with a zero moment point base omniirectional walk controller. Reinforcement learning is use to map the robot walking state, consisting of foot configuration an onboar sensory information, to the best combination of the three biomechanical responses neee to reject external perturbations. Experimental results show how this online metho can stabilize an inexpensive, commerciallyavailable DARwin-OP small humanoi robot. Keywors: Bipeal Omniirectional Walking, Full Boy Push Recovery, Reinforcement Learning, Online Learning I. I NTRODUCTION Fig. 1. Overview of the omniirectional walk controller integrate with full boy push recovery controller. Due to their small footprint an high center of mass, bipeal humanoi robots are not statically stable. Open loop ynamic walking methos typically assume flat, well-efine surfaces for walking that ensure the pre-efine joint trajectories exhibit ynamic stability. However, these techniques can fail ue to unevenness of the surface, collisions with obstacles, an unknown moeling errors of the robot or its actuators. Active stabilization is therefore crucial for operation of humanoi robots in realistic environments, an has been a topic of great interest in humanoi research. There have been two main approaches propose to hanle active stabilization of humanoi robots. The first approach uses sensitive force sensors an an accurate full boy moel of the robot to calculate the proper joint torques require to reject any external isturbance forces [1], [2], [3], [4], [5]. The other is a biomechanically motive approach which focuses on fast, reactive push recovery behaviors using a simplifie moel of the robot [6], [7], [8], [9], [10], [11], [12]. One common rawback of these approaches is that most physical implementations require specialize harware such as triaxial force an torque sensors, torque-controlle actuators, in aition to rapi computational processing an feeback control, making their implementation on inexpensive, commercially-available, position-controlle humanoi robots such as the Nao1 or DARwIn-OP2 infeasible. In previous work, we escribe a machine learning approach to learn a hierarchical full boy push recovery controller for such harware constraine humanoi robots [13]. In this paper, we aress several shortcomings of the prior work. The first issue is that our previous work, along with most other humanoi push recovery implementations, assumes that the robot is either staning still or walking in place, an oes not aress more general situations when the robot is walking with nonzero velocity. The secon issue is that a simulator was use to learn the controller, like other approaches utilizing machine learning [4], [5], which may not correctly moel the robot an environmental properties. Thus, the aim of this work is twofol. The first is to esign an integrate walk controller with push recovery for positioncontrolle humanoi robots without force sensors that can stabilize the robot against external isturbances uring omniirectional walking. The secon is to use the physical robot an experimental apparatus instea of a simulate environment to learn the push recovery controller parameters in an online fashion. We first esign a step-base omniirectional walk controller that integrates with the biomechanically motivate push recovery controllers. Our metho generates foot an GRASP Laboratory, University of Pennsylvania, Philaelphia, PA {yiseung,lee}@seas.upenn.eu BI Laboratory, Seoul National University, Seoul, Korea. btzhang@ceas.snu.ac.kr RoMeLa Laboratory, Virginia Tech, Blacksburg, VA hong@vt.eu /11/$ IEEE 1

2 torso trajectories in real time base upon ynamic stability criteria, which can be switche to reject external perturbations. The current foot configuration an walking phase are taken into consieration to etermine the control inputs for push recovery controllers. The robot is then use in conjunction with a motorize moving platform to apply a series of controlle perturbations to the robot. The parameters for the hierarchical controller are then learne in an online fashion using reinforcement learning. Experimental results show that our metho can be successfully applie to the DARwin-OP robot platform. The remainer of the paper procees as follows. Section II reviews three biomechanically motivate push recovery controllers an its implementation on position controlle humanoi robots. Section III explains the etails of the stepbase omniirectional walk controller which is fully integrate with the push recovery controller. Section IV explains how the DARwIn-OP robot is use to learn the appropriate controller from experience in an online fashion. Section V shows the experimental results using the learne controller. Finally, we conclue with a iscussion of outstaning issues an potential future irections arising from this work. II. B IOMECHANICALLY MOTIVATED PUSH RECOVERY CONTROL FOR POSITION CONTROLLED ROBOTS Biomechanical stuies show that humans isplay three istinctive motion patterns in response to suen external perturbations: which we enote as ankle, hip an step push recovery strategies [7]. Although there has been some theoretical analysis of these strategies using simplifie moels, physical implementation of such analytical controllers on a generic, position controlle humanoi robot is not straightforwar, an there has been little research on how to optimally mix these three strategies as humans o. Instea of fully relying on analytic moels, we suggeste a machine learning approach to etermine the appropriate push recovery controller which minimizes a preetermine cost function [14]. To generate the proper combination of push recovery strategies, a hierarchical high level controller uses current proprioceptive an inertial sensory information to etermine the optimal combination of the three recovery strategies. In this section, we review the implementation of the three biomechanically motivate push recovery controllers on a position controlle robot, as shown in Figure 2. (c) Fig. 2. Three biomechanically motivate push recovery strategies an corresponing controller for a position-controlle robot. Ankle strategy that applies control torque on ankle joints. Hip strategy which uses angular acceleration of torso an limbs to apply counteractive groun reaction force. (c) Step strategy which moves the base of support to a new position. as θankle = xankle (1) where θankle is the joint angle bias an xankle is the original ankle controller input. In aition to the ankle joints, we also moulate arm position to apply aitional effective torque at the ankles in a similar way, unless overrien by the hip controller. A. Ankle push recovery The ankle controller applies control torque on the ankle joints to keep the center of mass within the base of support. For position controlle actuators, controlling the ankle torque can be one by either controlling the auxiliary zero moment point (ZMP) which accelerates the torso to apply effective torque at ankle [13], [15] or moulating the target angle of the ankle servo. In this work we use the latter metho, which is foun to be effective for the particular robot we use in our experiments. Then the controller can be simply implemente B. Hip push recovery The hip controller uses angular acceleration of the torso an limbs to generate a backwar groun reaction force to pull the center of mass back towars the base of support. For maximum effect, a bang-bang profile of the following form can be use τhip (t) = τmax u(t) 2τmax u(t TR1 ) + τmax u(t TR2 ) 2 (2)

3 where u(t) is the unit step function, τ max is the maximum torque that the joint can apply, T R1 is the time the torso stops accelerating an T R2 is the time torso comes to a stop. After T R2, the torso angle shoul return to the initial position. This two-stage control scheme can be approximately implemente with position controlle actuators as { xhip 0 t < T R2 θ torso = T x R3 t (3) hip T R3 T R2 T R2 t < T R3 where θ torso is the torso pose bias, T R3 the time torso angle completes returning to initial position, an x hip is the input of hip controller. Arm rotation can also be use uring hip push recovery to apply aitional groun reaction force on the robot. C. Step push recovery The step controller effectively moves the base of support by taking a step. This is implemente by overriing the step controller to insert a new step with relative target foot position x capture. In orer to not lift the current support foot, the state of the robot nees to be monitore to etermine the current foot configuration as well as the perturbation irection. Only uring the appropriate walking phase is the walk control overrien with the new target foot position. III. A STEP-BASED OMNIDIRECTIONAL WALK CONTROLLER WITH PUSH RECOVERY CONTROL In this section, we escribe the etails of our omniirectional walk controller which is integrate with the full boy push recovery controller. As the active push recovery requires walk phase moulation an real-time moification of laning position, we cannot irectly use a typical perioic time-base walk controller. Instea, we use a step-base walk controller that generates a series of steps with iniviual ajustable parameters such as uration, support foot selection an laning position. The overall walk control is separate into a step controller an trajectory controller, where the step controller etermines the parameters for each step an the trajectory controller generates foot an torso position trajectories base upon that information. In this section we cover each controller in etail, an show how they are integrate with the high level push recovery controller escribe in the previous section. A. Step controller The step controller etermines the parameters of each step, which is efine as ST EP i = {SF,WT,t ST EP,L i,t i,r i,l 1+1,T i+1,r i+1 } (4) where SF enotes the support foot, WT enotes the type of the step, t ST EP is the uration of the step, an L i,t i,r i, an L i+1,t i+1,r i+1 are the initial an final 2D poses of left foot, torso an right foot in (x,y,θ) coorinate. L i,t i,r i are etermine by the final feet an torso poses from the last step, an L i+11,r i+1 is calculate using the comman walk velocity an current foot configuration to enable omniirectional walking. Foot reachability an self-collision constraints are Fig. 3. The step-base walk controller. An example of walking behavior which is compose of two steps, ST EP i an ST EP i+1. Corresponging ZMP an torso trajectory p an x. Timing parameters of φ 1 = 0.2 an φ 2 = 0.8 are use. also taken into account when calculating target foot poses. Target torso pose T i+1 is set to the mile point of L i+1 an R i+1 by efault, so that the transition occurs at the most stable posture where the center of mass (CoM) lies on the mipoint of the two support positions. Once we have the initial an final poses of the feet an torso, we can efine the reference ZMP trajectory p i (φ) as the following piecewise-linear function for the left support case p i (φ) = T i (1 φ φ φ 1 ) + L i φ 1 0 φ < φ 1 L i φ 1 φ < φ 2 T i+1 (1 1 φ ) + L i 1 φ φ 2 φ < 1 or for the right support case p i (φ) = T i (1 φ φ φ 1 ) + R i φ 1 0 φ < φ 1 R i φ 1 φ < φ 2 T i+1 (1 1 φ ) + R i 1 φ φ 2 φ < 1 where φ is the walk phase an φ 1,φ 2 are the timing parameters etermining the transition between single support an ouble support phase. Finally, the step controller allows for inter-step overrie from the push recovery controller. The hip an step push recovery controller can temporarily stop the walking to stabilize the robot after each push recovery behavior is initiate, an the step push recovery controller can initiate a special capture step to reject large perturbations. The walk type parameter W T is use to escribe these special types of steps. B. Trajectory controller The trajectory controller generates foot an torso trajectories for the current step efine in (4). First we efine the single support walk phase φ single as φ single = 0 0 φ < φ 1 φ φ 1 φ 2 φ 1 φ 1 φ < φ 2 1 φ 2 φ < 1 (5) (6) (7) 3

4 then we use following parameterize trajectory function to generate the foot trajectories f x (φ) = φ α + βφ(1 φ) (8) L i (φ single ) = L i+1 f x (φ single ) + L i (1 f x (φ single )) (9) R i (φ single ) = R i+1 f x (φ single ) + R i (1 f x (φ single )) (10) The torso trajectory x i (t) is calculate accoring to the following ZMP criterion for a linear inverte penulum moel p = x t ZMP ẍ (11) The piecewise linear ZMP trajectory we use in (5), (6) yiels for x i (φ) with zero ZMP error uring the step perio x i (φ) = p i (φ) + a p i eφ/φ ZMP + a n i e φ/φ ZMP φ ZMP m i sinh φ φ 1 φ ZMP 0 φ < φ 1 p i (φ) + a p i eφ/φ ZMP + a n i e φ/φ ZMP φ 1 φ < φ 2 p i (φ) + a p i eφ/φ ZMP + a n i e φ/φ ZMP φ ZMP n i sinh φ φ 2 φ ZMP φ 2 φ < 1 (12) where φ ZMP = t ZMP /t ST EP an m i, n i are ZMP slopes which are efine as follows for the left support case an for the right support case m i = (L i T i )/φ 1 (13) n i = (L i T i+1 )/(1 φ 2 ) (14) m i = (R i T i )/φ 1 (15) n i = (R i T i+1 )/(1 φ 2 ) (16) Then the parameters a p i an a n i can be uniquely etermine by the bounary conition x i (0) = T i an x i (1) = T i+1. This analytic solution has zero ZMP error uring the step perio but iscontinuous jerk at the transitions. However, as this transition occurs in the mile of the most stable ouble support stance, we foun this oes not hamper stability. In aition to calculating foot trajectories base upon preetermine target foot poses, the intra-step overrie from the push recovery controller can also moify the foot laning position while stepping. When the step push recovery is triggere uring the initial phase of walking, the target laning position is overrien an a new foot trajectory is generate uner foot reachability constraints an foot maximum velocity constraints. C. Push recovery controller The push recovery controller consists of three low level biomechanically motivate push recovery strategies an a high level controller that generates the control inputs for them base on sensory feeback an current state information. There is no close-form analytic solution for combining the iniviual low level controllers, so we use a machinelearning approach that trains the overall controller to optimize a cost function from experience. We formalize the high level controller as a reinforcement learning problem with the following state S = { θ IMU,θ gyro,θ f oot,φ,fd,hcs } (17) where θ IMU an θ gyro are the torso pose an gyroscope ata from inertial sensors, θ f oot is the support foot pose calculate using forwar kinematics an onboar sensors, φ is the walk phase, FD is the foot isplacement, an HCS is the hip controller state. The learne action is efine as the combine inputs for the three low level controllers A = { } x ankle,x hip,x capture (18) an the rewar is efine as R = θ gyro 2 + g z 0 θ IMU 2 (19) where g is the gravitational constant an z 0 is the COM height. IV. ONLINE LEARNING OF THE PUSH RECOVERY CONTROLLER We have implemente the integrate walk controller with push recovery on a commercially available small humanoi robot an traine the controller in an online fashion. In this section, we present the etails of the learning setup. A. Harware setup We use the commercially available DARwIn-OP humanoi robot evelope by Robotis Co., Lt. an the RoMeLa laboratory. It is 45 cm tall, weighs 2.8kg, an has 20 egrees of freeom. It has a USB camera for visual feeback, an 3- axis accelerometer an 3-axis gyroscope for inertial sensing. Position-controlle Dynamixel servos are use for actuators, which are controlle by a custom microcontroller connecte by an Intel Atom-base embee PC at a control frequency of 100Hz. To generate repeatable external perturbations, a motorize moving platform was constructe using Dynamixel servomotors. The motorize platform is attache to the same bus connecting the actuators of the robot, an controlle by the same I/O process. To generate maximum peak acceleration, the platform is slowly accelerate in one irection an then suenly accelerate in the opposite irection. We have foun the platform can generate accelerations greater than 0.5g while carrying the robot, proviing large enough perturbations to make the robot fall. B. Learning setup In previous work [13], a policy graient reinforcement learning algorithm was use to learn the push recovery controller in a simulate environment. However, the same approach cannot be irectly applie to the physical robot for online learning. The main issue with machine learning approaches on physical robots is that the amount of training ata is severely restricte. Unlike in simulation, small humanoi robots cannot continuously operate for long perios of time ue to heat builup at the actuators, an the process of gathering training ata is slower an may require 4

5 (c) Fig. 4. Learning setup incluing the servo controlle platform connecte to the DARwIn-OP robot. Commane position of the platform to inuce instantaneous isturbance. (c) Actual acceleration of the platform. Fig. 5. Learning process of the push recovery controller. Initial parameter set which oes not trigger hip strategy. Learne parameter set after training that triggers hip strategy when large amount of isturbance is applie. The same amount of isturbance is applie to the robot. more human intervention. Also, the sensory noise present in physical experiments are not well-moele in simulations. To overcome these problems, we simplify the reinforcement learning formulation of the high level controller as follows. First we use the heuristic isturbance variable θ as a single continuous state variable which is efine as θ = s(θimu + kgyro θgyro ) V. E XPERIMENTAL RESULTS A. Learning the push recovery controller (20) We traine the push recovery controller using the servo controlle platform. The robot is set to walk in ifferent irections, an a platform movement is triggere at ifferent phases of the walking. Then the robot is repositione by the human operator to start a new trial. Each trial takes roughly 10 secons on average, an 20 trials are one per episoe to improve the controller. Figure 5 shows a comparison of the robot behavior before an after 20 episoes of training with the same amount of perturbation. We can see that the robot learns to apply the appropriate push recovery behavior to reject large perturbations uring walking. where s is a moving average smoothing function an kgyro is a heuristic mixing parameter. The rest of the state variables are iscretize to form the iscrete state variables ˆ. ˆ HCS S = φˆ, FD, (21) Simple parametric functions with preset parameters kankle, khip, kstep are then use to escribe the possible controller actions: θ < θankle 0 DB kankle (θ θankle (S )) θ θankle xankle = DB (S )) θ θ kankle (θ + θankle ankle (22) θ < θhip 0 khip θ θhip xhip = (23) khip θ θhip T H θ < θstep (S ) 0 kstep θ θstep xcapture = (24) T H kstep θ θstep (S ) B. Testing the push recovery controller We let the robot with learne controller freely walk over a flat surface an applie a number of pushes with various irections an magnitue. Figure 6 shows some examples of robot response against external isturbances3. We see that the learne controller can successfully trigger appropriate push recovery behaviors to keep the omniirectionally walking robot from falling own. VI. C ONCLUSIONS Finally, to reuce the effects of incorrect actions uring normal walking, a negative training set is generate by letting the robot walk without any external perturbations on the platform to prevent the controller from learning overly sensitive corrections. We have emonstrate an integrate controller that enables full boy push recovery uring omniirectional walking 3 5

6 for humanoi robots without specialize sensors an actuators. Three low level biomechanically motivate push recovery strategies are implemente on a position controlle humanoi robot, an integrate with a non-perioic, stepbase omniirectional walk controller. The proper parameters for the hierarchical controller are learne online using a commercially-available small humanoi robot along with a servo-controlle moving platform. Experimental results show that the traine controller can successfully initiate a full boy push recovery behavior uner external perturbations while walking in an arbitrary irection. Possible future work inclues incorporating more sophisticate learning algorithms to utilize the limite training ata, an implementing these algorithms on full-size humanoi robots. ACKNOWLEDGMENTS We acknowlege the support of the NSF PIRE program uner contract OISE This work was also partially supporte by the IT R&D program of MKE/KEIT (KI002138, MARS), the inustrial strategic technology evelopment program ( ) fune by the Korean government (MKE), an the BK21-IT program. R EFERENCES [1] S.-H. Hyon an G. Cheng, Disturbance rejection for bipe humanois, ICRA, pp , apr [2] J. Park, J. Haan, an F. C. Park, Convex optimization algorithms for active balancing of humanoi robots, IEEE Transactions on Robotics, vol. 23, no. 4, pp , [3] S.-H. Hyon, R. Osu, an Y. Otaka, Integration of multi-level postural balancing on humanoi robots, in ICRA, 2009, pp [4] T. Matsubara, J. Morimoto, J. Nakanishi, S.-H. Hyon, J. G. Hale, an G. Cheng, Learning to acquire whole-boy humanoi center of mass movements to achieve ynamic tasks, Avance Robotics, vol. 22, no. 10, pp , [5] A. Yamaguchi, S.-H. Hyon, an T. Ogasawara, Reinforcement learning for balancer embee humanoi locomotion, in Humanois, ec. 2010, pp [6] B. Jalgha, D. C. Asmar, an I. Elhajj, A hybri ankle/hip preemptive falling scheme for humanoi robots, in ICRA, [7] M. Aballah an A. Goswami, A biomechanically motivate twophase strategy for bipe upright balance control, in ICRA, 2005, pp [8] J. Pratt, J. Carff, an S. Drakunov, Capture point: A step towar humanoi push recovery, in Humanois, 2006, pp [9] T. Komura, H. Leung, S. Kuoh, an J. Kuffner, A feeback controller for bipe humanois that can counteract large perturbations uring gait, in ICRA, 2005, pp [10] D. N. Nenchev an A. Nishio, Ankle an hip strategies for balance recovery of a bipe subjecte to an impact, Robotica, vol. 26, no. 5, pp , [11] B. Stephens, Humanoi push recovery, in Humanois, [12] B.-K. Cho an J.-H. Oh, Practical experiment of balancing for a hopping humanoi bipe against various isturbances, in IROS, 2010, pp [13] S.-J. Yi, B.-T. Zhang, an D. D. Lee, Online learning of uneven terrain for humanoi bipeal walking. in AAAI 10, [14] S.-J. Yi, B.-T. Zhang, D. Hong, an D. D. Lee, Learning full boy push recovery control for small humanoi robots. in ICRA, [15] S. Kajita, M. Morisawa, K. Haraa, K. Kaneko, F. Kanehiro, K. Fujiwara, an H. Hirukawa, Bipe walking pattern generator allowing auxiliary zmp control, in IROS, oct. 2006, pp (c) () (e) (f) Fig. 6. Responses of the learne push recovery controller against perturbation uring omniirectional walking. step strategy uring walking forwar. step strategy uring siestepping. (c) hip strategy uring walking forwar. () hip strategy uring turning. (e) hip an step strategies uring walking forwar. (f) hip an step strategies uring siestepping. 6

Practical Bipedal Walking Control on Uneven Terrain Using Surface Learning and Push Recovery

Practical Bipedal Walking Control on Uneven Terrain Using Surface Learning and Push Recovery 2011 IEEE/RSJ International Conference on Intelligent Robots and Systems September 25-30, 2011. San Francisco, CA, USA Practical Bipedal Walking Control on Uneven Terrain Using Surface Learning and Push

More information

Online Learning of Low Dimensional Strategies for High-Level Push Recovery in Bipedal Humanoid Robots

Online Learning of Low Dimensional Strategies for High-Level Push Recovery in Bipedal Humanoid Robots 2013 IEEE International Conference on Robotics and Automation (ICRA) Karlsruhe, Germany, May 6-10, 2013 Online Learning of Low Dimensional Strategies for High-Level Push Recovery in Bipedal Humanoid Robots

More information

GAIT PARAMETER ADAPTATION TO ENVIRONMENTAL PERTURBATIONS IN QUADRUPEDAL ROBOTS

GAIT PARAMETER ADAPTATION TO ENVIRONMENTAL PERTURBATIONS IN QUADRUPEDAL ROBOTS May 25, 27 13:6 WSPC - Proceeings Trim Size: 9in x 6in clawar7 1 GAIT PARAMETER ADAPTATION TO ENVIRONMENTAL PERTURBATIONS IN QUADRUPEDAL ROBOTS E. GARCIA, J. ESTREMERA, P. GONZALEZ DE SANTOS an M. ARMADA

More information

Towards bipedal running of a six-legged robot

Towards bipedal running of a six-legged robot Towars bipeal running of a six-legge robot N. Neville an M. Buehler neville@cim.mcgill.ca, buehler@cim.mcgill.ca Ambulatory Robotics Laboratory Centre for Intelligent Machines, McGill University Montreal,

More information

Dynamic locomotion with four and six-legged robots 1

Dynamic locomotion with four and six-legged robots 1 Dynamic locomotion with four an six-legge robots M Buehler, U Saranli 2, D Papaopoulos an D Koitschek 2 Centre for Intelligent Machines, Ambulatory Robotics Laboratory, McGill University 2 Department of

More information

ZMP Trajectory Generation for Reduced Trunk Motions of Biped Robots

ZMP Trajectory Generation for Reduced Trunk Motions of Biped Robots ZMP Trajectory Generation for Reduced Trunk Motions of Biped Robots Jong H. Park School of Mechanical Engineering Hanyang University Seoul, 33-79, Korea email:jong.park@ieee.org Yong K. Rhee School of

More information

Control of Dynamic Gaits for a Quadrupedal Robot

Control of Dynamic Gaits for a Quadrupedal Robot Control of Dynamic Gaits for a Quarupeal Robot Christian Gehring, Stelian Coros, Marco Hutter, Michael Bloesch, Markus A. Hoepflinger an Rolan Siegwart Autonomous Systems Laboratory, ETH Zurich, Switzerlan,

More information

Emergent walking stop using 3-D ZMP modification criteria map for humanoid robot

Emergent walking stop using 3-D ZMP modification criteria map for humanoid robot 2007 IEEE International Conference on Robotics and Automation Roma, Italy, 10-14 April 2007 ThC9.3 Emergent walking stop using 3-D ZMP modification criteria map for humanoid robot Tomohito Takubo, Takeshi

More information

Experimental Approach for the Fast Walking by the Biped Walking Robot MARI-1

Experimental Approach for the Fast Walking by the Biped Walking Robot MARI-1 Experimental Approach for the Fast Walking by the Bipe Walking Robot MARI-1 Youji Nakajima* Akira Yonemura Atsuo Kawamura Dept. of Elec. an Comp. Eng., Yokohama National University 79-5 Tokiwaai, Hoogaya-ku

More information

Dynamically stepping over large obstacle utilizing PSO optimization in the B4LC system

Dynamically stepping over large obstacle utilizing PSO optimization in the B4LC system 1 Dynamically stepping over large obstacle utilizing PSO optimization in the B4LC system QI LIU, JIE ZHAO, KARSTEN BERNS Robotics Research Lab, University of Kaiserslautern, Kaiserslautern, 67655, Germany

More information

Gait Pattern Generation and Stabilization for Humanoid Robot Based on Coupled Oscillators

Gait Pattern Generation and Stabilization for Humanoid Robot Based on Coupled Oscillators 2011 IEEE/RSJ International Conference on Intelligent Robots and Systems September 25-30, 2011. San Francisco, CA, USA Gait Pattern Generation and Stabilization for Humanoid Robot Based on Coupled Oscillators

More information

Body Stabilization of PDW toward Humanoid Walking

Body Stabilization of PDW toward Humanoid Walking Body Stabilization of PDW toward Humanoid Walking Masaki Haruna, Masaki Ogino, Koh Hosoda, Minoru Asada Dept. of Adaptive Machine Systems, Osaka University, Suita, Osaka, 565-0871, Japan ABSTRACT Passive

More information

Humanoid Robots and biped locomotion. Contact: Egidio Falotico

Humanoid Robots and biped locomotion. Contact: Egidio Falotico Humanoid Robots and biped locomotion Contact: Egidio Falotico e.falotico@sssup.it Outline What is a Humanoid? Why Develop Humanoids? Challenges in Humanoid robotics Active vs Passive Locomotion Active

More information

A Walking Pattern Generation Method for Humanoid robots using Least square method and Quartic polynomial

A Walking Pattern Generation Method for Humanoid robots using Least square method and Quartic polynomial 7 A Walking Pattern Generation Method for Humanoid robots using Least square method and Quartic polynomial Seokmin Hong *,,Yonghwan Oh Young-Hwan Chang and Bum-Jae You * University of Science and Technology(UST),

More information

EVOLVING GOALKEEPER BEHAVIOURS FOR SIMULATED SOCCER COMPETITION

EVOLVING GOALKEEPER BEHAVIOURS FOR SIMULATED SOCCER COMPETITION Proceeings of the 3r IASTED International Conference on Artificial Intelligence an Applications (AIA 2003 September 8-0, 2003, Benalmáena, Spain EVOLVING GOALKEEPER BEHAVIOURS FOR SIMULATED SOCCER COMPETITION

More information

Process Name Material Handling/MSD Prevention Program

Process Name Material Handling/MSD Prevention Program CNM WAY PROCESS CNM Process Name Material Hanling/MSD Prevention Program (04/10/2018 Revision) Overview of Material Hanling/MSD Prevention Program Purpose: To provie a safe an healthy working environment

More information

Improvement of Humanoid Walking Control by Compensating Actuator Elasticity

Improvement of Humanoid Walking Control by Compensating Actuator Elasticity 216 IEEE-RAS 16th International Conference on Humanoid Robots (Humanoids) Cancun, Mexico, Nov 15-17, 216 Improvement of Humanoid Walking Control by Compensating Actuator Elasticity Jeeseop Kim 1, Mingon

More information

Using sensory feedback to improve locomotion performance of the salamander robot in different environments

Using sensory feedback to improve locomotion performance of the salamander robot in different environments Using sensory feedback to improve locomotion performance of the salamander robot in different environments João Lourenço Silvério Assistant: Jérémie Knüsel Structure of the presentation: I. Overview II.

More information

YAN GU. Assistant Professor, University of Massachusetts Lowell. Frederick N. Andrews Fellowship, Graduate School, Purdue University ( )

YAN GU. Assistant Professor, University of Massachusetts Lowell. Frederick N. Andrews Fellowship, Graduate School, Purdue University ( ) YAN GU Assistant Professor, University of Massachusetts Lowell CONTACT INFORMATION 31 University Avenue Cumnock 4E Lowell, MA 01854 yan_gu@uml.edu 765-421-5092 http://www.locomotionandcontrolslab.com RESEARCH

More information

Stable Upright Walking and Running using a simple Pendulum based Control Scheme

Stable Upright Walking and Running using a simple Pendulum based Control Scheme 1 Stable Upright Walking and Running using a simple Pendulum based Control Scheme H.-M. MAUS, J. RUMMEL and A. SEYFARTH Lauflabor Locomotion Laboratory, University of Jena, Germany E-mail: moritz.maus@uni-jena.de

More information

Gait Analysis of a Little Biped Robot. Received May 2015; accepted July 2015

Gait Analysis of a Little Biped Robot. Received May 2015; accepted July 2015 ICIC Express Letters Part B: Applications ICIC International c216 ISSN 2185-2766 Volume 7, Number 5, May 216 pp. 1 6 Gait Analysis of a Little Biped Robot Chi-Sheng Tsai 1, Chen-Huei Hsieh 1, Wenning QIU

More information

A Bio-inspired Behavior Based Bipedal Locomotion Control B4LC Method for Bipedal Upslope Walking

A Bio-inspired Behavior Based Bipedal Locomotion Control B4LC Method for Bipedal Upslope Walking 1 A Bio-inspired Behavior Based Bipedal Locomotion Control B4LC Method for Bipedal Upslope Walking JIE ZHAO, QI LIU, STEFFEN SCHUETZ, and KARSTEN BERNS Robotics Research Lab, University of Kaiserslautern,

More information

Sensing and Modeling of Terrain Features using Crawling Robots

Sensing and Modeling of Terrain Features using Crawling Robots Czech Technical University in Prague Sensing and Modeling of Terrain Features using Crawling Robots Jakub Mrva 1 Faculty of Electrical Engineering Agent Technology Center Computational Robotics Laboratory

More information

Decentralized Autonomous Control of a Myriapod Locomotion Robot

Decentralized Autonomous Control of a Myriapod Locomotion Robot Decentralized utonomous Control of a Myriapod Locomotion Robot hmet Onat Sabanci University, Turkey onat@sabanciuniv.edu Kazuo Tsuchiya Kyoto University, Japan tsuchiya@kuaero.kyoto-u.ac.jp Katsuyoshi

More information

Toward a Human-like Biped Robot with Compliant Legs

Toward a Human-like Biped Robot with Compliant Legs Book Title Book Editors IOS Press, 2003 1 Toward a Human-like Biped Robot with Compliant Legs Fumiya Iida a,b,1, Yohei Minekawa a Juergen Rummel a and Andre Seyfarth a a Locomotion Laboratory, University

More information

Biomechanics and Models of Locomotion

Biomechanics and Models of Locomotion Physics-Based Models for People Tracking: Biomechanics and Models of Locomotion Marcus Brubaker 1 Leonid Sigal 1,2 David J Fleet 1 1 University of Toronto 2 Disney Research, Pittsburgh Biomechanics Biomechanics

More information

Motion Control of a Bipedal Walking Robot

Motion Control of a Bipedal Walking Robot Motion Control of a Bipedal Walking Robot Lai Wei Ying, Tang Howe Hing, Mohamed bin Hussein Faculty of Mechanical Engineering Universiti Teknologi Malaysia, 81310 UTM Skudai, Johor, Malaysia. Wylai2@live.my

More information

Walking Experiment of Biped Robot with Antagonistic Actuation Using Non-Linear Spring

Walking Experiment of Biped Robot with Antagonistic Actuation Using Non-Linear Spring , March 16-18, 2016, Hong Kong Walking Experiment of Biped Robot with Antagonistic Actuation Using Non-Linear Spring Takashige Yano, Jae Hoon Lee, Member, IAENG and Shingo Okamoto 1 Abstract The purpose

More information

arxiv: v1 [cs.ro] 28 Feb 2017

arxiv: v1 [cs.ro] 28 Feb 2017 Robust Bipedal Locomotion Control Based on Model Predictive Control and Divergent Component of Motion Milad Shafiee-Ashtiani, 1 Aghil Yousefi-Koma, 1 and Masoud Shariat-Panahi 2 arxiv:170208742v1 [csro]

More information

Human Pose Tracking III: Dynamics. David Fleet University of Toronto

Human Pose Tracking III: Dynamics. David Fleet University of Toronto Human Pose Tracking III: Dynamics David Fleet University of Toronto CIFAR Summer School, 2009 Interactions with the world are fundamental Implausible motions [Poon and Fleet, 01] Kinematic Model: damped

More information

Sample Solution for Problem 1.a

Sample Solution for Problem 1.a Sample Solution for Problem 1.a 1 Inverted Pendulum Model (IPM) 1.1 Equations of Motion and Ground Reaction Forces Figure 1: Scheme of the Inverted Pendulum Model (IPM). The equations of motion of this

More information

ZSTT Team Description Paper for Humanoid size League of Robocup 2017

ZSTT Team Description Paper for Humanoid size League of Robocup 2017 Adult- ZSTT Team Description Paper for Humanoid size League of Robocup 2017 Jaesik Jeong, Youngsup Oh and Jeehyun Yang ZSTT E-mail: soulmatree@gmail.com Web: www.soulmatree.com Abstract. This paper describes

More information

Robots With Legs. Helge Wrede

Robots With Legs. Helge Wrede Robots With Legs Helge Wrede 27.11.2017 Outline Motivation Overview Properties Number of legs Balance Walking Basic Bipedal Implementation Dynamic Balancing Concepts 3D-LIPM 2 Motivation Figure: Side view

More information

DEVELOPMENT OF A FULL-SIZED BIPEDAL HUMANOID ROBOT UTILIZING SPRING ASSISTED PARALLEL FOUR-BAR LINKAGES WITH SYNCHRONIZED ACTUATION

DEVELOPMENT OF A FULL-SIZED BIPEDAL HUMANOID ROBOT UTILIZING SPRING ASSISTED PARALLEL FOUR-BAR LINKAGES WITH SYNCHRONIZED ACTUATION Proceedings of the ASME 2011 International Design Engineering Technical Conferences & Computers and Information in Engineering Conference IDETC/CIE 2011 August 28-31, 2011, Washington, DC, USA DETC2011-4

More information

The effects of gravity on human walking: a new test of the dynamic similarity hypothesis using a predictive model

The effects of gravity on human walking: a new test of the dynamic similarity hypothesis using a predictive model 2767 The Journal of Experimental Biology 211, 2767-2772 Publishe by The Company of Biologists 2008 oi:101242/jeb020073 The effects of gravity on human walking: a new test of the ynamic similarity hypothesis

More information

Journal of Chemical and Pharmaceutical Research, 2016, 8(6): Research Article. Walking Robot Stability Based on Inverted Pendulum Model

Journal of Chemical and Pharmaceutical Research, 2016, 8(6): Research Article. Walking Robot Stability Based on Inverted Pendulum Model Available online www.jocpr.com Journal of Chemical and Pharmaceutical Research, 2016, 8(6):463-467 Research Article ISSN : 0975-7384 CODEN(USA) : JCPRC5 Walking Robot Stability Based on Inverted Pendulum

More information

Velocity Based Stability Margins for Fast Bipedal Walking

Velocity Based Stability Margins for Fast Bipedal Walking Velocity Based Stability Margins for Fast Bipedal Walking Jerry E. Pratt 1 and Russ Tedrake 2 1 Florida Institute for Human and Machine Cognition jpratt@ihmc.us 2 Massachusettes Institute of Technology

More information

Effects of Ankle Stiffness on Gait Selection of Dynamic Bipedal Walking with Flat Feet

Effects of Ankle Stiffness on Gait Selection of Dynamic Bipedal Walking with Flat Feet 2 IEEE International Conference on Rehabilitation Robotics Rehab Week Zurich, ETH Zurich Science City, Switzerland, June 29 - July, 2 Effects of Ankle Stiffness on Gait Selection of Dynamic Bipedal Walking

More information

OPTIMAL TRAJECTORY GENERATION OF COMPASS-GAIT BIPED BASED ON PASSIVE DYNAMIC WALKING

OPTIMAL TRAJECTORY GENERATION OF COMPASS-GAIT BIPED BASED ON PASSIVE DYNAMIC WALKING OPTIMAL TRAJECTORY GENERATION OF COMPASS-GAIT BIPED BASED ON PASSIVE DYNAMIC WALKING Minseung Kim Dept. of Computer Science Illinois Institute of Technology 3201 S. State St. Box 2082 Chicago IL 60616

More information

REPORT DOCUMENTATION PAGE

REPORT DOCUMENTATION PAGE REPORT DOCUMENTATION PAGE Form Approved OMB NO. 0704-0188 The public reporting burden for this collection of information is estimated to average 1 hour per response, including the time for reviewing instructions,

More information

Stability Control of Bipedal Walking Robot

Stability Control of Bipedal Walking Robot Stability Control of Bipedal Walking Robot V.Mastanaiah Assistant Professor, Department of Mechanical Engineering, KG Reddy College of Engineering and Technology, Moinabad, Telangana, India. ABSTRACT:

More information

Simulation of the Hybtor Robot

Simulation of the Hybtor Robot Simulation of the Hybtor Robot Pekka Aarnio, Kari Koskinen and Sami Salmi Information and Computer Systems in Automation Helsinki University of Technology ABSTRACT A dynamic rigid body simulation model

More information

Toward a Human-like Biped Robot with Compliant Legs

Toward a Human-like Biped Robot with Compliant Legs Book Title Book Editors IOS Press, 23 1 Toward a Human-like Biped Robot with Compliant Legs Fumiya Iida a,b,1, Yohei Minekawa a Juergen Rummel a and Andre Seyfarth a a Locomotion Laboratory, University

More information

Depth Optimization of Designed New Ferry Berth

Depth Optimization of Designed New Ferry Berth International Journal on Marine Navigation an Safety of Sea Transportation olume Number 4 December 2007 Depth Optimization of Designe New Ferry Berth S. Gucma & S. Jankowski Maritime University of Szczecin,

More information

Programming Self-Recovery in the humanoid Leong Ti Xean 1 Yap Kian Tiong 2

Programming Self-Recovery in the humanoid Leong Ti Xean 1 Yap Kian Tiong 2 Programming Self-Recovery in the humanoid Leong Ti Xean 1 Yap Kian Tiong 2 1. INTRODUCTION 1.1 Background In October 2000, Honda announced the ASIMO humanoid robot, capable of interpreting the postures

More information

In memory of Dr. Kevin P. Granata, my graduate advisor, who was killed protecting others on the morning of April 16, 2007.

In memory of Dr. Kevin P. Granata, my graduate advisor, who was killed protecting others on the morning of April 16, 2007. Acknowledgement In memory of Dr. Kevin P. Granata, my graduate advisor, who was killed protecting others on the morning of April 16, 2007. There are many others without whom I could not have completed

More information

Spider Robot for Motion with Quasistatic. Force Constraints

Spider Robot for Motion with Quasistatic. Force Constraints Spider Robot for Motion with Quasistatic Force Constraints Shraga Shoval, Elon Rimon and Amir Shapira Technion - Israel Institute of Technology - Haifa, Israel 32000. Abstract In quasistatic motions the

More information

An investigation of kinematic and kinetic variables for the description of prosthetic gait using the ENOCH system

An investigation of kinematic and kinetic variables for the description of prosthetic gait using the ENOCH system An investigation of kinematic and kinetic variables for the description of prosthetic gait using the ENOCH system K. OBERG and H. LANSHAMMAR* Amputee Training and Research Unit, University Hospital, Fack,

More information

Biped locomotion on the Hoap2 robot

Biped locomotion on the Hoap2 robot Biped locomotion on the Hoap robot December 15, 6 Christian Lathion Computer Science Master Project Biologically Inspired Robotics Group (BIRG) Ecole Polytechnique Fédérale de Lausanne Contents 1 Introduction

More information

1. A tendency to roll or heel when turning (a known and typically constant disturbance) 2. Motion induced by surface waves of certain frequencies.

1. A tendency to roll or heel when turning (a known and typically constant disturbance) 2. Motion induced by surface waves of certain frequencies. Department of Mechanical Engineering Massachusetts Institute of Technology 2.14 Analysis and Design of Feedback Control Systems Fall 2004 October 21, 2004 Case Study on Ship Roll Control Problem Statement:

More information

Omnidirectional Humanoid Balance Control: Multiple Strategies for Reacting to a Push

Omnidirectional Humanoid Balance Control: Multiple Strategies for Reacting to a Push UBC CS TECHNICAL REPORT TR-2006-11 1 Omnidirectional Humanoid Balance Control: Multiple Strategies for Reacting to a Push KangKang Yin, Department of Computer Science University of British Columbia, Canada

More information

Dynamic analysis and motion measurement of ski turns using inertial and force sensors

Dynamic analysis and motion measurement of ski turns using inertial and force sensors Available online at www.sciencedirect.com Procedia Engineering 6 ( 213 ) 355 36 6th Asia-Pacific Conference on Sports Technology Dynamic analysis and motion measurement of ski turns using inertial and

More information

Faster and Smoother Walking of Humanoid HRP-2 with Passive Toe Joints *

Faster and Smoother Walking of Humanoid HRP-2 with Passive Toe Joints * Faster and Smoother Walking of Humanoid HRP-2 with Passive Toe Joints * Ramzi Sellaouti *1, Olivier Stasse *2, Shuuji Kajita *3, Kazuhito Yokoi *1 and Abderrahmane Kheddar *2 *1 JRL, AIST *2 JRL, CNRS

More information

Policy Gradient RL to learn fast walk

Policy Gradient RL to learn fast walk Policy Gradient RL to learn fast walk Goal: Enable an Aibo to walk as fast as possible Policy Gradient RL to learn fast walk Goal: Enable an Aibo to walk as fast as possible Start with a parameterized

More information

Controlling Walking Behavior of Passive Dynamic Walker utilizing Passive Joint Compliance

Controlling Walking Behavior of Passive Dynamic Walker utilizing Passive Joint Compliance Controlling Walking Behavior of Passive Dynamic Walker utilizing Passive Joint Compliance Takashi TAKUMA, Koh HOSODA Department of Adaptive Machine Systems, Graduate School of Engineering Osaka University

More information

Biorobotic Locomotion: Biped Humanoid Walking. using Optimal Control

Biorobotic Locomotion: Biped Humanoid Walking. using Optimal Control Biorobotic Locomotion: Biped Humanoid Walking using Optimal Control A Thesis Presented to The Academic Faculty by Malavika Bindhi In Partial Fulfillment of the Requirements for the Degree Bachelor of Science

More information

Kochi University of Technology Aca Study on Dynamic Analysis and Wea Title stem for Golf Swing Author(s) LI, Zhiwei Citation 高知工科大学, 博士論文. Date of 2015-03 issue URL http://hdl.handle.net/10173/1281 Rights

More information

Walking Gait Generation with Foot Placement Control for the HOAP-3 Humanoid Robot

Walking Gait Generation with Foot Placement Control for the HOAP-3 Humanoid Robot Walking Gait Generation with Foot Placement Control for the HOAP-3 Humanoid Robot Yazhou Huang, Robert Backman and Marcelo Kallmann UCM School of Engineering Technical Report TR-2011-002 University of

More information

RECENTLY, various humanoid robots have been

RECENTLY, various humanoid robots have been Stability Improvement Using Soft Sole on Humanoid Robot Masanao Koeda 1, Tsuneo Yoshikawa 1, and Keita Nakagawa 1 1 Ritsumeikan University, College of Information Science and Engineering, Department of

More information

RUNNING ON SOFT GROUND: SIMPLE, ENERGY-OPTIMAL DISTURBANCE REJECTION

RUNNING ON SOFT GROUND: SIMPLE, ENERGY-OPTIMAL DISTURBANCE REJECTION CLAWAR 2012 Proceedings of the Fifteenth International Conference on Climbing and Walking Robots and the Support Technologies for Mobile Machines, Baltimore, MD, USA, 23 26 July 2012 543 RUNNING ON SOFT

More information

Efficient Gait Generation using Reinforcement Learning

Efficient Gait Generation using Reinforcement Learning Efficient Gait Generation using Reinforcement Learning Josep M Porta and Enric Celaya Institut de Robòtica i Informàtica Industrial, UPC-CSIC, Barcelona, Spain. SYNOPSIS The use of a free gait becomes

More information

arxiv: v2 [cs.ro] 12 Jan 2017

arxiv: v2 [cs.ro] 12 Jan 2017 Walking on Partial Footholds Including Line Contacts with the Humanoid Robot Atlas* Georg Wiedebach 1, Sylvain Bertrand 1, Tingfan Wu 1, Luca Fiorio 2, Stephen McCrory 1, Robert Griffin 1, Francesco Nori

More information

arxiv: v1 [cs.ro] 27 Jul 2016

arxiv: v1 [cs.ro] 27 Jul 2016 Walking on Partial Footholds Including Line Contacts with the Humanoid Robot Atlas* Georg Wiedebach 1, Sylvain Bertrand 1, Tingfan Wu 1, Luca Fiorio 2, Stephen McCrory 1, Robert Griffin 1, Francesco Nori

More information

Reactive Balance Control in Walking based on a Bipedal Linear Inverted Pendulum Model

Reactive Balance Control in Walking based on a Bipedal Linear Inverted Pendulum Model 2011 IEEE International Conference on Robotics and Automation Shanghai International Conference Center May 9-13, 2011, Shanghai, China Reactive Balance Control in Walking based on a Bipedal Linear Inverted

More information

Development of Fish type Robot based on the Analysis of Swimming Motion of Bluefin Tuna Comparison between Tuna-type Fin and Rectangular Fin -

Development of Fish type Robot based on the Analysis of Swimming Motion of Bluefin Tuna Comparison between Tuna-type Fin and Rectangular Fin - Development of Fish type Robot based on the Analysis of Swimming Motion of Bluefin Tuna Comparison between Tuna-type Fin and Rectangular Fin - Katsuya KUGAI* Abstract The swimming motion of Tuna type fishes

More information

Learning Energy Efficient Walking Based on Ballistics

Learning Energy Efficient Walking Based on Ballistics Learning Energy Efficient Walking Based on Ballistics Masaki Ogino, Koh Hosoda and Minoru Asada Dept. of Adaptive Machine Systems, Graduate School of Engineering,, HANDAI Frontier Research Center ogino@er.ams.eng.osaka-u.ac.jp,

More information

Gait planning for biped locomotion on slippery terrain

Gait planning for biped locomotion on slippery terrain Gait planning for biped locomotion on slippery terrain Martim Brandão, Kenji Hashimoto, José Santos-Victor and Atsuo Takanishi Abstract We propose a new biped locomotion planning method that optimizes

More information

Abstract 1. INTRODUCTION

Abstract 1. INTRODUCTION Design and Development of a Biped Humanoid Robot to Generate Dynamic Walking Pattern Shivaraj D. 1, Cyril Prasanna Raj P. 2, Lasitha M. 3 1- M.Sc. [Engg.] Student, 2- Professor and Head, 3- Assistant Professor

More information

Robot motion by simultaneously wheel and leg propulsion

Robot motion by simultaneously wheel and leg propulsion Robot motion by simultaneously wheel and leg propulsion Aarne Halme, Ilkka Leppänen, Miso Montonen, Sami Ylönen Automation Technology Laboratory Helsinki University of Technology PL 5400, 02015 HUT, Finland

More information

Control of BIOLOID based on Floor Projection of Center of Mass for Ascending Stairs

Control of BIOLOID based on Floor Projection of Center of Mass for Ascending Stairs International OPEN ACCESS Journal Of Modern Engineering Research (IJMER) Control of BIOLOID based on Floor Projection of Center of Mass for Ascending Stairs Abhinay Jiwankar 1, Faraz Deshmukh 2, Prasanna

More information

Slip Observer for Walking on a Low Friction Floor

Slip Observer for Walking on a Low Friction Floor Slip Observer for Walking on a Low Friction Floor Kenji KANEKO, Fumio KANEHIRO, Shuuji KAJITA, Mitsuharu MORISAWA Kiyoshi FUJIWARA, Kensuke HARADA, and Hirohisa HIRUKAWA National Institute of Advanced

More information

Walking Control Algorithm of Biped Humanoid Robot on Uneven and Inclined Floor

Walking Control Algorithm of Biped Humanoid Robot on Uneven and Inclined Floor J Intell Robot Syst (27) 48:457 484 DOI 1.17/s1846-6-917-8 Walking Control Algorithm of Biped Humanoid Robot on Uneven and Inclined Floor Jung-Yup Kim & Ill-Woo Park & Jun-Ho Oh Received: 31 July 26 /

More information

Kungl Tekniska Högskolan

Kungl Tekniska Högskolan Centre for Autonomous Systems Kungl Tekniska Högskolan hic@kth.se March 22, 2006 Outline Wheel The overall system layout : those found in nature found in nature Difficult to imitate technically Technical

More information

Centre for Autonomous Systems

Centre for Autonomous Systems Centre for Autonomous Systems Kungl Tekniska Högskolan hic@kth.se March 22, 2006 Outline Wheel The overall system layout : those found in nature found in nature Difficult to imitate technically Technical

More information

PERCEPTIVE ROBOT MOVING IN 3D WORLD. D.E- Okhotsimsky, A.K. Platonov USSR

PERCEPTIVE ROBOT MOVING IN 3D WORLD. D.E- Okhotsimsky, A.K. Platonov USSR PERCEPTIVE ROBOT MOVING IN 3D WORLD D.E- Okhotsimsky, A.K. Platonov USSR Abstract. This paper reflects the state of development of multilevel control algorithms for a six-legged mobile robot. The robot

More information

arxiv: v1 [cs.ro] 6 May 2018

arxiv: v1 [cs.ro] 6 May 2018 Comparison Study of Nonlinear Optimization of Step Durations and Foot Placement for Dynamic Walking Wenbin Hu, Iordanis Chatzinikolaidis, Kai Yuan, and Zhibin Li arxiv:85.55v [cs.ro] 6 May 8 Abstract This

More information

Emergency Stop Algorithm for Walking Humanoid Robots

Emergency Stop Algorithm for Walking Humanoid Robots Emergency Stop Algorithm for Walking Humanoid Robots Mitsuharu Morisawa, Shuuji Kajita, Kensuke Harada, Kiyoshi Fujiwara Fumio Kanehiro, Kenji Kaneko, Hirohisa Hirukawa National Institute of Advanced Industrial

More information

LQG Based Robust Tracking Control of Blood Gases during Extracorporeal Membrane Oxygenation

LQG Based Robust Tracking Control of Blood Gases during Extracorporeal Membrane Oxygenation 2011 American Control Conference on O'Farrell Street, San Francisco, CA, USA June 29 - July 01, 2011 LQG Based Robust Tracking Control of Blood Gases during Extracorporeal Membrane Oxygenation David J.

More information

Robotics and Autonomous Systems

Robotics and Autonomous Systems Robotics and Autonomous Systems Lecture 4: Locomotion Richard Williams Department of Computer Science University of Liverpool 1 / 57 Today 2 / 57 Motion Two aspects: Locomotion Kinematics Locomotion: What

More information

Trajectory Planning for Smooth Transition of a Biped Robot

Trajectory Planning for Smooth Transition of a Biped Robot Proceedings of the 003 IEEE International Conference on Robotics & Automation Taipei, Taiwan, September 14-19, 003 Trajectory Planning for Smooth Transition of a Biped Robot Zhe Tang 1,, Changjiu Zhou,

More information

Robotics and Autonomous Systems

Robotics and Autonomous Systems Robotics and Autonomous Systems Lecture 4: Locomotion Simon Parsons Department of Computer Science University of Liverpool 1 / 57 Today 2 / 57 Motion Two aspects: Locomotion Kinematics Locomotion: What

More information

Controlling Velocity In Bipedal Walking: A Dynamic Programming Approach

Controlling Velocity In Bipedal Walking: A Dynamic Programming Approach Controlling Velocity In Bipedal Walking: A Dynamic Programming Approach Thijs Mandersloot and Martijn Wisse Delft University of Technology Delft, Netherlands thijs.mandersloot@gmail.com, m.wisse@tudelft.nl

More information

CONFIRMATION OF PHD CANDIDATURE DAMIEN KEE 2003

CONFIRMATION OF PHD CANDIDATURE DAMIEN KEE 2003 CONFIRMATION OF PHD CANDIDATURE DAMIEN KEE 2003 List of Publications: Wyeth G, Kee D, Yik T, Evolving a Locus based Gait for a Humanoid Robot, Proceedings of the International Conference on Intelligent

More information

General Safety Notes for Chain Slings (Grade 50/60) Last revised: January 2018

General Safety Notes for Chain Slings (Grade 50/60) Last revised: January 2018 General Safety Notes for Chain Slings (Grae 50/60) Last revise: January 2018 Ketten Wäler GmbH Chain Technology Gewerbegebiet 5 83093 Ba Enorf, Germany Fon +49 (0)80 53-20 29-10 Fax +49 (0)80 53-20 29-31

More information

Study of Dynamic Biped Locomotion on Rugged Terrain - Derivation and Application of the Linear Inverted Pendulum Mode -

Study of Dynamic Biped Locomotion on Rugged Terrain - Derivation and Application of the Linear Inverted Pendulum Mode - Proceedings of the 1991 IEEE Intemational Conference on Robotics and Automation Sacramento, California - April 1991 Study of Dynamic Biped Locomotion on Rugged Terrain - Derivation and Application of the

More information

The Design of ZMP Measure System for Biped Robot LI Bin 1, a, LI Zhihai 2, b, LI Jiejia 1, c, BU Chunguang 2, d

The Design of ZMP Measure System for Biped Robot LI Bin 1, a, LI Zhihai 2, b, LI Jiejia 1, c, BU Chunguang 2, d 2nd International Conference on Electrical, Computer Engineering and Electronics (ICECEE 2015) The Design of ZMP Measure System for Biped Robot LI Bin 1, a, LI Zhihai 2, b, LI Jiejia 1, c, BU Chunguang

More information

Using GPOPS-II to optimize sum of squared torques of a double pendulum as a prosthesis leg. Abstract

Using GPOPS-II to optimize sum of squared torques of a double pendulum as a prosthesis leg. Abstract Using GPOPS-II to optimize sum of squared torques of a double pendulum as a prosthesis leg Abstract Milad Zarei MCE 593 Prosthesis Design & Control A two-dimensional, two links pendulum is developed to

More information

BIPED TRANSFORMER. Group No. 9

BIPED TRANSFORMER. Group No. 9 BIPED TRANSFORMER Group No. 9 Name Roll Number Aditya Vikram Singh 11010305 Dhiraj Gandhi 11010321 Jagjeet Singh 11010326 Mayank Sanghani 11010336 Sriram Kumar 11010365 Vikas Singh 11010371 Abstract: This

More information

Tether-based Robot Locomotion Experiments in REX-J mission

Tether-based Robot Locomotion Experiments in REX-J mission Tether-based Robot Locomotion Experiments in REX-J mission H. Nakanishi*, M. Yamazumi*, S. Karakama*, M. Oda*, S. Nishida****, H. Kato**, K. Watanabe*, A. Ueta**, M. Yoshii***, S. Suzuki*** *Tokyo Institute

More information

Designing falling motions for a humanoid soccer goalie

Designing falling motions for a humanoid soccer goalie Designing falling motions for a humanoid soccer goalie Tobias Wilken, Marcell Missura and Sven Behnke University of Bonn Institute for Computer Science VI D-53117 Bonn, Germany {wilken, missura, behnke}@cs.uni-bonn.de

More information

Foot Placement in the Simplest Slope Walker Reveals a Wide Range of Walking Solutions

Foot Placement in the Simplest Slope Walker Reveals a Wide Range of Walking Solutions Foot Placement in the Simplest Slope Walker Reveals a Wide Range of Walking Solutions Pranav A. Bhounsule Abstract We show that the simplest slope walker can walk over wide combinations of step lengths

More information

Compliant Attitude Control and Stepping Strategy for Balance Recovery with the Humanoid COMAN

Compliant Attitude Control and Stepping Strategy for Balance Recovery with the Humanoid COMAN 2013 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS) November 3-7 2013. Tokyo Japan Compliant Attitude Control and Stepping Strategy for Balance Recovery with the Humanoid COMAN

More information

A Study on the Human Impulse Characteristics Of the Standing Shooting Posture

A Study on the Human Impulse Characteristics Of the Standing Shooting Posture A Study on the Human Impulse Characteristics Of the Standing Shooting Posture Young-Shin Lee 1, a, Young-Jin Choi 2,b, Kyu-Hyun Han 2,c, Je-Wook Chae 3,d, Eui-Jung Choi 3,e and In-Woo Kim 3,f 1 Dept. of

More information

Limit Cycle Walking and Running of Biped Robots

Limit Cycle Walking and Running of Biped Robots Tokyo Institute of Technology Yamakita Lab. Limit Cycle Walking and Running of Biped Robots Masaki Yamakita Tokyo Institute of Technology Introduction of Yamakita Lab. 1/14 Other Research Topics State

More information

An Energy Efficient Dynamic Gait for a Nao Robot

An Energy Efficient Dynamic Gait for a Nao Robot An Energy Efficient Dynamic Gait for a Nao Robot Zhenglong Sun, Nico Roos Department of Knowledge Engineering, Maastricht University P.O. Box 66, 62 MD Maastricht, The Netherlands Abstract This paper presents

More information

Simulation-based design to reduce metabolic cost

Simulation-based design to reduce metabolic cost Simulation-based design to reduce metabolic cost Overview: Lecture + Hands On Exercise 1. Generating and evaluating a muscledriven simulation of walking 2. Metabolics 101 3. Designing and evaluating devices

More information

Analysis of Pressure Rise During Internal Arc Faults in Switchgear

Analysis of Pressure Rise During Internal Arc Faults in Switchgear Analysis of Pressure Rise During Internal Arc Faults in Switchgear ASANUMA, Gaku ONCHI, Toshiyuki TOYAMA, Kentaro ABSTRACT Switchgear include devices that play an important role in operations such as electric

More information

Proof Copy. Controlling the Walking Period of a Pneumatic Muscle Walker. Takashi Takuma Koh Hosoda. Abstract. 1. Introduction

Proof Copy. Controlling the Walking Period of a Pneumatic Muscle Walker. Takashi Takuma Koh Hosoda. Abstract. 1. Introduction Takashi Takuma Koh Hosoda Department of Adaptive Machine Systems Graduate School of Engineering, Osaka University Yamadaoka 2 1, Suita, Osaka 565 0871, Japan {takuma,hosoda}@ams.eng.osaka-u.ac.jp Controlling

More information

Skippy: Reaching for the Performance Envelope

Skippy: Reaching for the Performance Envelope Workshop on Dynamic Locomotion and Manipulation ETH Zürich, July 2016 Skippy: Reaching for the Performance Envelope Roy Featherstone 2016 Roy Featherstone What is Skippy? a hopping and balancing machine

More information

Dynamic Lateral Stability for an Energy Efficient Gait

Dynamic Lateral Stability for an Energy Efficient Gait Dynamic Lateral Stability for an Energy Efficient Gait Zhenglong Sun a Nico Roos a a Department of Knowledge Engineering, Maastricht University P.O. Box 616, 6200 MD Maastricht, The Netherlands Abstract

More information