Active balance of humanoid movement based on dynamic task-prior system

Size: px
Start display at page:

Download "Active balance of humanoid movement based on dynamic task-prior system"

Transcription

1 Research Article Active balance of humanoid movement based on dynamic task-prior system International Journal of Advanced Robotic Systems May-June 2017: 1 13 ª The Author(s) 2017 DOI: / journals.sagepub.com/home/arx Chengju Liu, Jing Ning, Kang An and Qijun Chen Abstract To maintain human-like active balance in a humanoid robot, this article proposes a dynamic priority-based multitask algorithm to avoid self-collision during highly complex robotic whole-body motions and rebalance after external disturbance using momentum compensation strategies. On the one hand, the conflict between self-collision and self-balance constraints in task-space merging with end-effector tracking tasks are considered in the multitask algorithm to improve the robot s balance. On the other hand, for self-balance during the robot s movement, momentum compensation is considered as one task and utilized to reject unknown disturbances. Two strategies are put forward to restrain the sudden change in momentum. One is to calculate the correction in the joint space with the resolved momentum control (RMC) method; the other is to add an end-effector tracking motion in the task space. Simulations and experiments on a full-body humanoid robot validate the effectiveness of the proposed method. Experiments on both a simulation and a full-body humanoid are designed to validate the task-prior algorithm. With the proposed method, the humanoid robot succeeds in avoiding self-collision during movement and is able to rectify itself to the preplanned steady stance while encountering undefined external forces. Keywords Humanoid walking, active balance, multitask system, self-collision avoidance, momentum compensation Date received: 28 November 2016; accepted: 4 April 2017 Topic: Special Issue - Multi-Modal Fusion for Robotics Topic Editor: Huaping Liu Associate Editor: Huaping Liu Introduction Robust locomotion is fundamental for a humanoid robot to maneuver in an unstructured and undetermined human environment. To realize the biped robust walking, multimodal data fusion technologies, 1 7 the trajectory online generation methods, 8 10 and the online optimization strategies are all needed to be integrated to realize maximum degree of biped walking robustness. Currently, humanoid walking is commonly realized by planning the center of mass (CoM) trajectories so that the resultant zero moment point (ZMP) 11,12 trajectory follows a desired ZMP trajectory. For real-time implementation, a humanoid robot was represented by a mass-concentrated model, whereas a simplified dynamics model is generally used. 13,14 However, while these control methods can realize humanoids walking in an ideal environment, small irregularities of terrain or a change in the mass distribution of the CoM may cause the robots to lose balance during walking. To realize adaptive walking in unknown conditions, disturbances from the external environment, such as pushes and terrain irregularities, and self-collision with the robot itself need to be considered. The state of the art balance control of biped robots has solved different problems of movement tasks. However, School of Electronics and Information Engineering, Tongji University, Shanghai, China Corresponding author: Chengju Liu, School of Electronics and Information Engineering, Tongji University, Room 719A, Zhixin Building, Tongji University, Cao an Road 4800#, Shanghai , China. liuchengju@tongji.edu.cn Creative Commons CC BY: This article is distributed under the terms of the Creative Commons Attribution 4.0 License ( which permits any use, reproduction and distribution of the work without further permission provided the original work is attributed as specified on the SAGE and Open Access pages ( open-access-at-sage).

2 2 International Journal of Advanced Robotic Systems there is no complete control framework that embraces different conditions, including stand balancing, walking balance with disturbance, self-collision avoidance, and reactive stepping from standing position. In task-space-based robot motion control, the priority of the subtasks is often fixed. However, when the number of subtasks in the robot motion control is large and the coupling of each subtask is complicated, this simple static priority strategy can no longer be applied to the cooperation among the control tasks. For example, on the one hand, in humanoid robot walking control, the walking foot of the robot needs to complete the tracking task of the scheduled walking track, and on the other hand, it can be used to generate the momentum compensation movement needed to improve the balance of the humanoid robot while walking. However, a higher priority of the trajectory tracking task does not always exist. When the robot is in the bipedal support stage, it is of course necessary for the footrest to satisfy the constraint requirement that the relative support foot has no movement and is in close contact with the ground. During the robot support stage, the control of the robot s foot is only concerned with its position and position tracking during the rising and falling phases and does not care about the movement of the foot in the swing phase. At this time, the swing foot can be used to complete the more important task of momentum compensation. Therefore, a more reasonable strategy in robot motion control is that the control subtasks can dynamically switch priorities according to the current control needs during the movement of the robot and realize more flexible multitask cooperative control. Therefore, presenting a frame of the robot motion task space control method with dynamic priority switching is very necessary. In the dynamic priority robotic task space control framework, the system first determines the priorities of each subtask dynamically according to the current requirements of robot motion control and ranks the tasks according to the priority order. The underlying task first maps the motion control output to the zero space of the upper layer task control according to the differential motion control and the corresponding Jacobian matrix and then merges the mapped control output into the upper-layer task control output. The process is iterated step by step and, with the additional constraints (such as robot joint clipping, joint movement speed and collision constraints and other constraints), eventually produces the joint motion of the robot command to complete the robot s integrated motion control. In this article, a novel online active balance control framework based on a dynamic priority-based multitask algorithm is presented. The current balance strategies can be treated as subtasks in the dynamic multitask algorithm, whereas the self-collision avoidance, foot position compensation, and momentum compensation strategies are treated as tasks in the dynamic priority-based multitask algorithm. In this work, we pay attention to the self-collision avoidance and momentum compensation strategies during standing and walking balance with external disturbances. For self-avoidance in humanoid robots during whole-body movement, such as swinging arms, three steps are applied to address the problem: first, to construct bounding segments of the robot according to 3-D geometry; second, to select candidate pairs through prior knowledge, and finally, to achieve the task of avoiding self-collision. For the momentum compensation strategies, from the perspective of momentum, the robot falling down equals a dramatic increase in angular momentum if one of the feet is regarded as a fulcrum. The humanoid s base angle is utilized as the feedback signal to compensate for angular momentum. Meanwhile, if the disturbance causes a deviation of the CoM, linear momentum needs to be compensated as well. The resolved motion rate control (RMRC) method/differential inverse kinematics (DIK) is introduced to solve the redundant problem. 15 The null-space method is utilized to address task priority. 16 The influences of external perturbations on robots can be regarded as the offset of CoM and the change in momentum. The prior-based dynamic multitasking system is used to switch and merge the trajectory tracking task and the momentum compensation task. This article is organized as follows: The related work about how to improve biped walking stability and maintain balance is introduced in the second section. Third section elaborates on the basic theory, including redundant kinematics and the multitask mechanism; gait generation based on linear inverted pendulum mode (LIPM); and the resolved momentum control method. Self-collision constraints are explained in the fourth section. The presented momentum compensation strategy is introduced in the fifth section. Sixth section verifies the validity of the multitask mechanism with self-collision avoidance and momentum compensation algorithms by simulation experiments. We conclude this study and suggest future work in the seventh section. Related work Self-collision is an important physical constraint on wholebody motion planning for a humanoid robot. During task operating, the swing arm may collide with the leg during biped walking, which will affect the balance of walking. Therefore, self-collision is an unavoidable problem in humanoid robot balancing and needs to be considered during adaptive walking. Kwon et al. 17 extended the research area from traditional collision between the robot and the external environment to self-collision with the robot itself. If several tasks are to be executed at the same time, task space methods can be applied to the multitask problem under redundant joint space, which has a low time cost and divides complicated tasks into uncomplicated tasks to represent a complex joint space. Nakanishi et al. 18 implemented multiple tasks under a task space by priority allocation. Sugiura et al. 19 proposed that self-collision can be described as a task in a task space and gives the function

3 Liu et al. 3 of collision avoidance, but this was based on partial coordinates. Cheng et al. 20 invented the concept of self-collision avoidance, with a focus of interest on dynamically predicting and selecting link pairs to be checked. To improve biped walking stability and maintain balance, some strategies as to how to effectively use the whole body to improve walking ability have been proposed For example, arm-swing strategies 25,26 are used during biped walking to compensate for the movements of the swing leg and stabilize robot posture. Currently, although several types of arm-swing strategies have been proposed, they are difficult to execute simultaneously. Kobayashi et al. 27 proposed a two-stage integration method of the two arm-swing strategies for bipedal walking to enhance both stability and efficiency. To achieve external environment disturbance rebalancing, different strategies have been proposed to compensate for nonzero variations in momentum, 22,28,29 regulate CoM, or online adjust the foot position through sensory feedback control Considering humanoid momentum compensation, Englsberger and Ott 28 invented a walking methodology based on a capture point, which integrates CoM vertical motion and angular momentum change. Ugurlu et al. 22 created a strategy to rotate a humanoid s upper body to compensate for undesired yaw movement when the robot walks. Chang et al. 29 estimated the robot state and regulated the angular momentum of CoM and steps to recover from a push, but pushes from left or right side were not examined. Dynamically adjustable foot positioning is an effective strategy for active balance. In our previous work, 30,31 a foot-positioning compensator was proposed to dynamically adjust the foot positioning of a humanoid robot according to the real-time state of the robot s CoM. Castano et al. 32 proposed a new online walking control that replanned the gait pattern based on foot placement control using the actual CoM state feedback. The analytical solution of foot placement is formulated based on the LIPM to recover the walking velocity and reject external disturbances. For the disturbance rejection of continuous walking, Wieber et al. 33,34 proposed an online walking gait generation approach, with both adjustable foot positioning and step duration based on the linear model predictive control scheme. However, only simulated experiments were developed, and no supporting area constraint was considered. Based on the preview control scheme, Nishiwaki and Kagami 35 proposed strategies to adjust future foot positioning and ZMP trajectory. Several typical experiments were developed on a real full-body humanoid robot to validate the effectiveness of their methods. Similar works also included foot positioning adjustment based on a feasible region and avoidance behavior from external forces for a human-carrying biped. 36,37 Stephens 38 utilized an integral control method to maintain standing balance and viewed the disturbance as impulsive. Liu and Atkeson 39 studied the balance of a robot standing based on a trajectory library, which is time consuming. These researchers only considered a robot s balancing under a static state rather than a dynamic steady state. Graf and Röfer 40 presented a robust closed-loop gait, which allowed the robot to react to external perturbations. Urbann and Hofmann 41 presented a reactive stepping algorithm based on the generation of walking motions with sensor feedback. The closed-form calculation of foot placement modifications, such as disturbances of the CoM position, could be balanced with negligible ZMP deviations. As shown in the aforementioned related works, the stateof-the-art balance control of biped robots has solved different problems of the movement tasks. However, there is no complete control framework that embraces different conditions, including stand balancing, walking balance with disturbance, self-collision avoidance, and reactive stepping from standing position. Algorithms A dynamic priority-based multitask mechanism and the related algorithms, including gait generation based on LIPM and the resolved momentum control method, are introduced in this section. Multitasks are merged in the way of a null-space projection according to their priorities. Self-collision avoidance and momentum compensation are considered as tasks and utilized to reject robot itself and external disturbances. Redundant kinematics and multitask mechanism The relationship between task space and joint space in the robot system can be described by a nonlinear function as follows T ¼ f ðyþ (1) where T ¼½T 1 T M Š T represents the manipulator endeffector s position and rotation, and y i in y ¼½y 1 ; ; y N Š T represents the link i s rotation or displacement relative to link i 1. The RMRC method is adopted to control the velocities of joints instead of directly controlling the joints. The differential kinematics and inverse kinematics of the robot system can be expressed as follows T_ ¼ JðyÞ y _ (2) _y ¼ J 1 ðyþ _ T (3) where JðyÞ is the Jacobian matrix and J 1 ðyþ is the inverse Jacobian matrix, which exists when JðyÞ is full rank. If N > M in equation (1), the robot system is redundant. Using a pseudo-inverse matrix instead of the inverse Jacobian matrix provides the following J # ¼ J T ðjj T Þ 1 (4)

4 4 International Journal of Advanced Robotic Systems r y x Q s r Figure 2. xy-cross section showing the step size s and the inverted pendulum origins r and r. Figure 1. Priority-based dynamic multitask frame. To avoid the singular problem, the damped least squares (DLS)methodcanbeappliedtoconstructthepseudoinverse matrix J # ¼ðJ T J þ l 2 IÞ 1 J T (5) where l is the damped constant value, which will ensure Jacobian matrix J # is full rank. Null space is defined as the linear combination of certain joints that will not make a difference in the motion of the end-effector, which can be expressed as N ¼ I J # J (6) With the help of a null-space projection operator, multitasks with different priorities can be executed at the same time, which can be described as follows # _y ¼ J 1 T_ # 1 þ N 1 J 2 T_ 2 (7) where task T 1 is prior to task T 2, and T 2 has no influence on T 1 through a null-space projection. The block diagram of the dynamic multitask mechanism based on priority is shown in Figure 1, where the higher priority task will be projected onto the null space of its lower priority task; finally, by linear superposition and an inverse kinematics calculation, the robot joint space can be configured. Gait generation based on LIPM In this section, a 3-D-LIPM is used to plan the CoM motion of the robot in order to generate a stable periodic gait. Then, the support foot and swing foot trajectories are designed according to the planned CoM. 40 The position and velocity of the CoM, relative to the origin of the inverted pendulum, are given by 1 xðtþ ¼x 0 coshðktþþ _x 0 sinhðktþ (8) k _xðtþ ¼x 0 k sinhðktþþ _x 0 coshðktþ (9) p where k ¼ ffiffiffiffiffiffiffi g=h ; g is the gravitational acceleration; h is the height of the CoM above the ground; and x 0 and _x 0 are the position and velocity of the CoM relative to the origin of the inverted pendulum at t ¼ 0, respectively. To eliminate a double-support phase, the point in time for altering the support leg must be determined. First, the point in time t ¼ 0 is defined as the time point for altering the support leg. When t ¼ 0, the y-component of the velocity is 0(ð _x 0 Þ y ¼ 0). The position of the CoM at this point,ðx 0 Þ y, is an arbitrary parameter and has a value greater or less than 0, depending on the active support leg. Thus, the function of the CoM s position in the y-direction during the range of t ¼ t b and t t e is as follows, which means a single-support phase starts at t ¼ t b and ends at t ¼ t e x y ðtþ ¼ðx 0 Þ y coshðktþ (10) If the swinging foot should be placed with a distance of r y þ s y r y relative to the supporting foot (Figure 2) at the end of the single-support phase, and if xðtþ and _xðtþ are the position and velocity of the CoM relative to the next pendulum origin, the point in time to alter the support leg can be determined by finding the ending of a single-support phase t e where ðxðt e ÞÞ y ðxðt b ÞÞ y ¼ r y þ s y r y (11) ð _xðt e ÞÞ y ¼ð_xðt b ÞÞ y (12) where t e and t b are calculated with an iterative method, 40 in which t e is initially guessed. Equation (10) can be transformed into t b ¼ 1 k arcsin h ðx! 0Þ y k sinhðkt e Þ ðx 0 Þ (13) yk to compute t b that matches t e. The guessed t e can then be determined using the velocity of the CoM at t e and length ðxðt e ÞÞ y ðxðt b ÞÞ y. To cover a step size, s x, the origin of the inverted pendulum of the next single-support phase should be placed at

5 Liu et al. 5 adistanceofr x þ s x r x from the origin of the current inverted pendulum. Additionally, the velocity in the x direction should remain the same value when the support leg alternates. Thus, the following equations can be obtained ðxðt e ÞÞ x ðxðt b ÞÞ x ¼ r x þ s x r x (14) ð _xðt e ÞÞ x ¼ð_xðt b ÞÞ x (15) To make sure that the position of the origin of the inverse pendulum is optimal in the next phase, we designate that r x ¼ 0 and ðxð0þþ x ¼ 0. When the CoM has the position x tb and velocity _x tb relative to the origin of Q (Q is located between the two feet as shown in Figure 2) at the beginning of a single-support phase, r x, ðx 0 Þ x and ð _x 0 Þ x can be computed using the following linear system of equations so that a complete set of pendulum parameters can be determined sinhðkt b Þ r x þðx 0 Þ x coshðkt b Þþð_x 0 Þ x ¼ðx tb Þ k x ðx 0 Þ x k sinhðkt b Þþð_x 0 Þ x coshðkt b Þ¼ð_x tb Þ x ðx 0 Þ x k sinhðkt e Þþð_x 0 Þ x coshðkt e Þ ðx 0 Þ x k sinhðkt b Þ ð_x 0 Þ x coshðkt b Þ¼0 sinhðkt e Þ r x þðx 0 Þ x coshðkt e Þþð_x 0 Þ x ðx 0 Þ k x coshðkt b Þ ð_x 0 Þ x sinhð kt b Þ k ¼ r x þ s x (16) After the CoM trajectory is known, the position of the support foot is given by the functions of x x ðtþ and x y ðtþ. The swing foot s trajectory, however, must be designed. The known position and length of the current singlesupport phase is used to obtain a percentage of the progressing phase as follows ðtþ ¼ t t b (17) t e t b The swing foot should be repositioned to the origin of the next inverse pendulum during the single-support phase. The motion of the swing foot contains movement in the xydirection and lift in the z-direction, which are defined relative to Q as follows mðtþ ¼ðs xy þ s xy Þ 1 cosð ðtþpþ s xy þf y (18) 2 1 cosð ðtþ2pþ lðtþ ¼s z (19) 2 where s xy and s xy are the current and next step size in the xy-direction, respectively;s z is the lift height in the z-direction; and f y is the foot position which only contains a y-component. Thus, the trajectory of the swinging foot can be determined. Finally, combining the target foot positions relative to the CoM and the CoM position relative to the torso by computing the current robot s stance, joint angles can be solved through inverse kinematics. Resolved momentum control The linear momentum, P ¼½P x P y P z Š T, and angular momentum, L ¼½L x L y L z Š T, refer to a robot CoM s changing rate, which are related to the stability and balance of the robot. For the whole system, momentum can be calculated as P ¼ ~me ~m^r " # B!~c M _y X_ B L 0 I H _y _y (20) where ~m is the mass of the whole robot; E is the 3 3 identity matrix; r B!~c is a 3 1 vector from base to CoM; ~I is the inertial matrix with respect to CoM; X_ v T B w T B ŠT is marked as the velocity of the robot s base; and^is an equivalent operator to a cross product that translates a 3 1 vector into a 3 3 matrix. M y _ and H_ y are 3 n matrices that represent the relationship between momentum and joint velocity, respectively. If the robot is modeled as several cascade links connected to the base link, M y _ and H_ y can be calculated in a recursive method. If we divide y, _ M y _, and H_ y into left leg joints, right leg joints, and passive joints, respectively, that means h i T _q ¼ _q T leg 1 _q T _q T leg 2 passive (21) M y _ ¼ ½ M leg 1 M leg1 M passive Š (22) H y _ ¼ ½ H leg 1 H leg1 H passive Š (23) where i ¼ 1 represents the left leg and i ¼ 2 represents the right leg. Then, equation (20) can be rewritten as follows P ¼ ~me ~m^r B!~c X_ B þ X2 M legi _y legi L 0 I H i¼1 legi þ M passive _y passive (24) H passive Considering that the humanoid s base is moving, the coordinate should be placed at a point free from the robot. If we choose the center between the two feet, which is fixed on the ground, as the coordinate origin and call this coordinate S F, the computation of a foot s velocity has to be corrected as follows X_ Fi ¼ E ^r B!F i X_ B þ J legi ylegi _ (25) 0 E where X v T F i w T F i Š T is marked as the velocity vector of the foot and r B!Fi is a 3 1 vector from base to the ith foot.

6 6 International Journal of Advanced Robotic Systems Figure 4. 3-D model represented by OBBs and distance between segment pair. OBB: object bounding boxe. Figure 3. Main flow from building 3-D model to collision avoidance. Then, the joint velocity of each leg can be computed as follows _y legi ¼ J 1 X_ leg Fi J 1 E ^r B!Fi X_ i leg B (26) i 0 E If equation (26) is substituted into equation (24), the momentum formula can be rewritten as follows " P ¼ M #" # " B M passive X_ B L HB þ X2 MF # i X_ Fi H passive where M B H B _y passive i¼1 H F i = ~me ~m^r " B!~c X2 M # F i E ^rb!fi 0 I i¼1 0 E " # M F i H F i = M leg i H legi H F i (27) (28) J 1 leg (29) With the equations above, if the reference momentum, ½P ref ; L ref Š T, and the two feet s reference velocity relative to base X_ ref F i are given, the base velocity, X_ B, and joint velocity, y, _ of the robot can be computed. Self-collision constraints When considering robot modeling, most researches simplify the robot to skeleton, but self-collision problem normally happens because of the 3-D geometry of robot. Self-collision means part of the robot may collide with other part of the robot. Collision-free path planning can be treated as an important constraint or task in robot motion planning and a necessary technique to maintain balance. To achieve this constraint, self-collision should first be detected. The whole architecture of the self-collision task is shown in Figure 3. The first step constructs bounding segments of the robot according to 3-D geometry, then selects candidate pairs through prior knowledge, and finally achieves the task of self-collision avoidance. The state postures of the links are related to the transform matrix, which varies along with the configuration of the joint space state. We use object bounding boxes (OBBs) to describe the robot s three-dimensional model (Figure 4) according to the joint connections of the robot. For a humanoid robot, the three-dimensional model of the robot can be divided into N segments. If s i represents one segment, the whole three-dimensional model can be expressed as S ¼fsigi ¼ 0::N and M j i ¼ Pair i6¼j fs i ; s j g, any two segments from these N segments are defined as a segment pair. For the collision checking of the simple OBB geometry, the separate axis theorem (SAT) is applied for fast collision detection between polygon meshes. 42 Differential distance calculation, by obtaining the closest point pair (Figure 4), can be expressed as d_ i;j ¼ f _ ðyþ y _ ¼ J i;j _ coll y (30) Collision avoidance can be considered as a subtask, T coll, in the task space, which aims to enlarge the distance, d i;j, between segment pair. Thus, the joint space configuration can be rewritten as # _y ¼ J coll T_ # coll þ N coll J 2 T_ 2 (31) where T coll is the collision avoidance task, which has a higher priority than T 2. Momentum compensation strategy Compensation setting It is known that the process of a robot falling down when it encounters disturbances can be considered as a mutation of the trunk angle under S F. From the perspective of momentum, a robot falling down equals a dramatic increase in angular momentum if one of the feet is regarded as a fulcrum. Therefore, we need to detect the humanoid s base angle, y B, with the help of the embedded inertial unit

7 Liu et al. 7 Figure 5. Humanoid robot platform. (a) NAO robot. (b) Approximate dynamic representation of each link of the robot. (c) The simulation environment (Webots). sensor. Then, y B is utilized as the feedback signal to compensate for angular momentum. Meanwhile, if a disturbance causes the deviation of the CoM, linear momentum needs to be compensated as well. When the momentum is compensated with the proportional control method, the formula can be expressed as DP ¼ K p1 ðp ref CoM p CoMÞ ~m (32) DL ¼ K p2 ðy ref B y BÞ~I (33) where K p1 and K p2 are scaling factors of linear momentum and angular, respectively; p ref and p CoM CoM refer to the expected CoM and measured CoM, respectively; y ref B and y B represent the expected trunk angle and measured trunk angle, respectively. Under general circumstances, we assume that y ref B ¼½0 0 0ŠT, which means that the robot s base is upright to the ground. In the RMC method, we set _ F i ¼ 0, denoting that the generated rate vector of joints is only used for momentum compensation. After the base rate, X_ B, and joint rate, y _ MLegi, for both legs are computed with the RMC formulas, the rotation of base and leg joints under the current joint configuration are computed as X ref Dynamic multitask integration y B ¼ y B þ o B (34) y Legi ¼ y Legi þ _ y MLegi (35) If the foot i is executing a trajectory tracking task T tracki,at the same time, the momentum compensation task should be considered as an extra task and be merged to T tracki, which can be written as follows _y Legi ¼ J Fi # _ T tracki þ N Fi _ ymlegi (36) When a robot encounters a strong disturbance, it may fail to adjust its stance promptly and avoid falling because of its intrinsic constraints, such as the limit of joint velocity. Therefore, we consider adding an extra momentum compensation task in the task space that is obtained by the RMRC method but not solved in the RMC manner. Compared with human actions, when an external force is received, it is found that a foot lift task opposite to the body tilt direction can be regarded as an effective solution to resisting an angular momentum change. In this way, when a robot s body has sufficient tilt, a foot lift task is added to maintain balance. The foot lift task can be merged with the momentum compensation task as follows _y Legi ¼ J Fi # _ T lifti þ N Fi _ ymlegi (37) where T lifti represents the lift task of foot i. Simulation and experiment Experiment platform To validate the proposed method, the robot NAO is used for the experiments (Figure 5(a)). The robot has 25 degrees of freedom (DOF), with 11 DOFs for the two legs. The height of this robot is approximately 50 cm during walking and its weight is 4.35 kg. The sensor data and the walking control module update at a rate of 50 frames per second. The difficulty in developing walking approaches on this robot lies in that each leg weighs almost the same as its body and the links of the robot are made of plastic, which makes the dynamics of the robot quite different from the simplified LIPM model. Additionally, disturbances brought with the deformation of the plastic links are also significant. To compute the local inertial tensor of each link of the body, the geometrical approximation of each part of the robot is given by the inertia tensor formula. As shown in Figure 5(b), the head of the robot is represented by a sphere of uniform quality, and the other parts are represented by rectangular parallelepipeds with uniform mass. The simulations are carried out under a physical simulation environment (Webots), as shown in Figure 5(c), and then dubbed to the real robot.

8 8 International Journal of Advanced Robotic Systems Figure 6. Trajectory of right hand with and without collision avoidance. Figure 8. Vertical collision avoidance snapshots. Collides with (a) and successful collision avoidance (b). Figure 7. Distance between and before and after works. Self-collision avoidance In this section, we combine the arm swing task with a selfcollision avoidance task. In the first experiment, the arm is designed to swing vertically with a shoulder pitch angle varyingintherangeof½30 ; 110 Š, which fulfills the requirement of fetching objects or swinging during standing and walking. Under this circumstance, the right hand s trajectory is computed through cubic polynomial interpolation. We choose the segments of lower arm and upper leg as the potential collision pair and detected the distance, d, between them in real time. If d is smaller than a specific value (such as 0.03 m), the self-collision avoiding task, T col, is added to the end-effector tracking task. Figure 5 demonstrates the trajectory of the right hand in the x, y, and z directions before and after collision avoidance. The distance between the right lower arm, S RLA, and right upper leg, S RUL, is shown in Figure 6, where d is enlarged by T col. The serrated waves shown in Figures 6 and 7 are due to the existence of T col. Simulations of the robot arm swing with and without collision avoidance are depicted in Figure 8. Figure 9. Snapshots of the collision avoidance during biped walking. (a) Walking with arm swing. (b) Bending forward. (c) Horizontal collision avoidance during arm swing. Furthermore, if we add arm-swing motions during biped walking, collision avoidance should be considered in order to maintain balance. Assuming that the walking task has a higher priority than the arm-swinging task. The robot can walk forward on a flat terrain stably while swinging both arms forward and backward, alternatively, to avoid self-collision. As shown in Figure 9, the second experiment is set as including walking, bending forward, and arm swinging, which are then converted to motion planning tasks merged with self-balancing constraints. When bending forward, the robot is expected to maintain balance at the same time. We design the CoM to move

9 Liu et al Roll Pitch Heading Body angle (rad) Time (s) Figure 10. Body angle curve. forward and downward slightly with momentum control method. Also, we set robot s feet standing on the ground and detect whether the CoM leaves the supporting polygon. Momentum compensation while standing Momentum compensation is applied under two circumstances in this experiment. One circumstance applies a sudden force to the robot when it is in a steady state, such as standing on the ground with double feet. The other creates disturbances while the robot is walking with a predefined fixed gait. The robot is in a static state while standing on the ground, which means the reference momentum is zero. If a sudden force is applied to the robot, its trunk will lean to one side and a CoM error will be caused. If the standing state is to be maintained, p ref CoM in equation (30) and yref B in equation (31) should be set to the CoM and body angle in the initial standing state, respectively. Dynamic multitasking should be assigned as follows ( J _y # _ F Leg1 ¼ 1 T lift1 þ N F1 ymleg1 _ y > y ref Bx Bx (38) J F # _ 1 T stand1 þ N F1 ymleg1 _ else ( J _y # _ F Leg2 ¼ 2 T lift2 þ N F2 ymleg2 _ y < y ref Bx Bx (39) J F # _ 2 T stand2 þ N F2 ymleg2 _ else where T stand1 and T stand2 represent the standing tasks of left foot and right foot, respectively, which means the foot is static and has parallel contact with the ground; T lift1 and T lift2 represent lift motion in the y z plane; and y ref B x is a positive threshold value which determines when multitasks are switched. Under such dynamic multitask strategy, the robot will remain standing on the ground and perform the momentum compensation if it just slants slightly but will lift the opposite foot in the tilt s direction and compensate momentum if the tilt exceeds the threshold. The body angle curve, the expected CoM versus measured CoM trajectories, and double feet trajectories are shown in Figures 10, 11, and 12, x (m) y (m) z (m) 8 Expected CoM Measured CoM Time (s) Time (s) Time (s) Figure 11. Trajectories of the expected CoM and measured CoM. CoM: center of mass. x (m) y (m) z (m) Time (s) Time (s) Left foot respectively (relative to S F ). The experimental results show that the robot inclines to the left and lifts the right foot because of the applied force occurring at approximately t ¼ 3s and then inclines to right, lifting the left foot and swaying backward and forward slightly due to the counterforce of the ground while putting down the right foot. At last, the robot returns to an upright state due to momentum compensation. Figure 13 demonstrates the snapshot sequences of the robot recovering from an external lateral disturbances, the largest force in this lateral disturbance rejection experiment almost with a maximum value of 10.8 N (this is just the maximum value in this simulation and not the maximum value for the NAO robot). Momentum compensation during walking Right foot Time (s) Figure 12. Trajectories of left and right feet. In this section, the 3-D-LIPM is used to plan the CoM motion to generate a stable periodic gait; then, the support

10 10 International Journal of Advanced Robotic Systems Figure 14. Sequences of robust walking. (a) Lateral disturbance from left hand. (b) Lateral disturbance from right hand. Figure 13. Snapshots sequences of NAO recovering from lateral external disturbance. (a) Small lateral disturbance from left hand. (b) Small lateral disturbance from right hand. (c) Larger lateral disturbance from left hand. (d) Larger lateral disturbance from right hand. foot and swing foot trajectories are designed according to the CoM. Uncertain disturbances are applied to the robot during this dynamic steady process. The term p ref CoM,in equation (32), is the output of LIPM, and y ref B in equation (33) is set to zero. In this case, the left foot and right foot alternate to function as the swing foot and support foot, and dynamic multitask integration is designed as follows 8 >< _y swleg ¼ >: 8 >< _y spleg ¼ >: J swf # T _ swflift þ N swf J swf # T _ swf J swf # T _ ; swf þ N swf ymswleg _ J # spf _ T spf J # spf _ T spf þ N spf _ ymspleg ; y Bx y Bx > y ref Bx p swf z > h F 5 else (40) > y ref Bx p swf z > h F 5 else (41) where T swf and T spf are the foot tracking trajectories of the walking task; T swflift is the lift motion in the y z plane added to the swing foot; p swfz is the height of the swing foot above ground; and h F is the maximum lift height of the swing foot motion while walking. As is expressed in the equations above, a foot lift task will be added to the swing foot, which has a higher priority than its original swing task if the robot s tilt is large Figure 15. Body attitude curve during walking. enough. Meanwhile, _ y MspLeg and _ y MswLeg are not included in momentum compensation because the foot lift task is actually designed for rejecting a sudden change in momentum. In other cases, the walking tasks and the momentum compensation task are executed at the same time. The task switching condition requires the swing foot to exceed a specific height to avoid friction between the foot and the ground. Additionally, it is worth noting that the foot lift task will not be active if the robot inclines in the opposite direction of the support foot (e.g., the robot inclines to the right with left foot support), because a self-collision may occur. The robustness of the reactive gait pattern against the lateral impulse is first studied. Figure 14 shows the sequences of robust walking when the robot has undergone two external forces from different directions. The disturbances appear at about t ¼ 6 s and t ¼ 14 s, both with a maximum value of approximately 9 N and the duration of the disturbance about 0.5 s. The body angle curve, expected CoM versus measured CoM trajectories, and double feet trajectories while walking are shown in Figures 15, 16, and 17, respectively (relative to S F ). If the left-oriented disturbance is imposed on the robot, the robot inclines to the left. When the robot inclines a

11 Liu et al. 11 Figure 16. Trajectories of the expected CoM and measured CoM. CoM: center of mass. Figure 17. Trajectories of the left and right feet. little, the RMC computed joint correction works and the walking task will not be terminated. With the growth of trunk tilt, the right foot lifts up and stretches out until the current single-support phase ends. In the next singlesupport phase, the right foot switches to the support foot and returns to its original position on the ground, while theleftfootpreparestoexecute the swing foot task. The robot moves on to a normal walking state in approximately 3 s. When the right-oriented disturbance occurs, the right foot acts as the support foot, while the left foot plays the role of the swing foot and the robot recovers from the force attack exactly as it did in the left-oriented force disturbance restoration. In addition, the swing foot lift task may cause a tracking error of the CoM, swing foot task, and support foot task but is of great help in maintaining balance. Conclusion and discussion Walking is the basic skill of a humanoid robot. Most of the current walking control methods adopt predefined foot and center of mass trajectories and control the robot with simplified dynamics model. These methods usually cannot resist with external disturbance and lack adaptation to the environment changes and therefore can be hardly used in real on-field applications. In general, the current disturbance rejection methods are mainly divided into balance method based on local acceleration of the body and balance method based on modifying the supporting structure of the robot and environment. These methods can only be effective for small disturbances, or only in the simulation environment. On the other hand, most of the current approaches only use one balance skill, and the skill designed according to anticipate specific behavior. For humanoid, the complex and flexible balance ability is more dependent on a variety of balancing skills integrated application. In this article, a priority-based dynamic multitasking frame is introduced under which multitasks are switched, merged, and executed. Collision avoidance can be considered as a subtask during highly complex robotic wholebody motions in the task space in order to avoid its influence on balance. A momentum compensation method was proposed, which explains that momentum changes caused by disturbances are suppressed by either joint correction computed with the RMC method or by a foot lift motion opposite to the robot s tilt. The validity of the proposed method is verified through experiments on an NAO robot. The results illustrate that, with the introduced algorithm, the robot will adjust itself to the predesigned static or dynamic steady state if uncertain forces are applied. In the next step work, a preview controller can be utilized to estimate the robot state, and more effective momentum compensation tasks, other than foot lift motion, will be added in the dynamic multitasking frame to realize an improved ability of the disturbance rejection. As we know, animals and humans in nature show the strange survival skills not only rely on long-term evolutionary process and genetic congenital acquisition, many behavioral skills are acquired through learning ability acquired. Even some seemingly innate skills are acquired through the practice and improvement can be applied to the current living environment. Such as humanoid balance skills, human needs to attempt many times to get the skills to prevent falling, like skating. Humans can still learn to adapt to walking ability. Another function of acquired learning is to improve the coordination of the various parts of the body and the simultaneous execution of various independent behaviors. As a result of repetitive exercises, we can accomplish tasks such as using the upper body part to complete the side water while balancing the walking. Therefore, to learn to change and improve the skills of humanoid robot is a flexible, robust, efficient, and essential to the ability to walk.

12 12 International Journal of Advanced Robotic Systems In the future work, the mechanism of the balancing skills in human walking will be studied and control methods of using active balancing skills to resist with external disturbance under unstructured and uncertain environment will be explored. Dynamics modeling of local acceleration balancing skills and supporting-polyhedron modification balancing skills will be designed and control architecture of multiple balancing skills cooperation will be investigated. The online skill learning algorithms will be explored in the future research. The work is targeted at exploring new theory and technology of humanoid walking control, breaking through the bottleneck of humanoid robot real application, and solving the basic and key problem of the adaptation of humanoid walking control. The result is critical for the production of new-generation humanoid robot, development of on-field and service robot, assisting robot and space robot, and so on. Acknowledgements The authors would like to express thanks to technicians in the Laboratory of Robotics and Intelligent Systems of Tongji University for their assistance during experiments. Declaration of conflicting interests The author(s) declared no potential conflict of interest with respect to the research, authorship, and/or publication of this article. Funding The author(s) disclosed receipt of the following financial support for the research, authorship, and/or publication of this article: This work was supported in part by the National Natural Science Foundation of China (grant nos and ) and the Fundamental Research Funds for the Central Universities, Basic Research Project of Shanghai Science and Technology Commission (grant no. 16JC ). References 1. Lahat D, Adali T and Jutten C. Multimodal data fusion: an overview of methods, challenges, and prospects. Proc IEEE 2015; 103(9): Dobrišek S, Gajšek R, Mihelič F, et al. Towards efficient multi-modal emotion recognition. IntJAdvRoboticSyst 2013; 10(1): Zheng E, Chen B, Wang X, et al. On the design of a wearable multi-sensor system for recognizing motion modes and sit-tostand transition. Int J Adv Robotic Syst 2014; 11(2): Liu H, Sun F, Fang B, et al. Robotic room-level localization using multiple sets of sonar measurements. IEEE Trans Instrum Meas 2017; 66(1): Liu H, Yu Y, Sun F, et al. Visual-tactile fusion for object recognition. IEEE Trans Autom Sci Eng 2017; 14(2): Liu H, Guo D, and Sun F. Object recognition using tactile measurements: Kernel sparse coding methods. IEEE Trans Instrum Meas 2016; 65(3): Liu H, Liu Y, and Sun F. Robust exemplar extraction using structured sparse coding. IEEE Trans Neural Netw Learn Syst 2015; 26(8): Heo JW and Oh JH. Biped walking pattern generation using an analytic method for a unit step with a stationary time interval between steps. IEEE Trans Ind Electron 2015; 62(2): Kim JW. Online joint trajectory generation of human-like biped walking. Int J Adv Robotic Syst 2014; 11(2): Whitman EC, Stephens BJ and Atkeson CG. Torso rotation for push recovery using a simple change of variables. In: IEEE-RAS International Conference on Humanoid Robots, Osaka, Japan, 29 November 1 December 2012, pp IEEE. 11. Huang Q, Yokoi K, Kajita S, et al. Planning walking patterns for a biped robot. IEEE Trans Robotics Autom 2001; 17(3): Seven U, Akbas T, Fidan KC, et al. Bipedal robot walking control on inclined planes by fuzzy reference trajectory modification. Soft Comput 2012; 16(11): Kajita S, Kanehiro F, Kaneko K, et al. The 3D linear inverted pendulum mode: a simple modeling for a biped walking pattern generation. In: IEEE International Conference on Intelligent Robots and Systems (IROS), Maui, HI, 29 October 3 November 2001, pp IEEE. 14. Kajita S, Kanehiro F, Kaneko K, et al. A real time pattern generator for biped walking. In: IEEE International Conference on Robotics and Automation (ICRA), Washington, DC, May 2002, pp IEEE. 15. Umetani Y and Yoshida K. Resolved motion rate control of space manipulators with generalized Jacobian matrix. IEEE Trans Robotics Autom 1989; 5(3): Liegeois A and Liegeois A. Automatic supervisory control of the configuration and behavior of multibody mechanisms. IEEE Trans Syst Man Cyber 1977; 7(12): Kwon S, Chung W, Youm Y, et al. Self-collision avoidance for n-link redundant manipulators. In: IEEE International Conference on System, Man, and Cybernetics, Charlottesville,VA, October 1991, pp IEEE. 18. Nakanishi J, Cory R, Mistry M, et al. Operational space control: a theoretical and empirical comparison. Int J Robotics Res 2008; 27(6): Sugiura H, Gienger M, Janssen H, et al. Real-time selfcollision avoidance for humanoids by means of nullspace criteria and task intervals. In: IEEE-RAS International Conference Humanoid Robots, Genova, Italy, 4 6 December 2006, pp IEEE. 20. Sugiura H, Gienger M, Janssen H, et al. Real-time self-collision avoidance for humanoids by means of nullspace criteria and task intervals. In: IEEE-RAS International Conference Humanoid Robots, Genova, Italy, 4 6 December 2006, pp IEEE. 21. Whitman EC, Stephens BJ, and Atkeson CG. Torso rotation for push recovery using a simple change of variables. In: IEEE-RAS International Conference on Humanoid Robots, Osaka, Japan, 29 November 1 December 2012, pp IEEE.

13 Liu et al Ugurlu B, Saglia JA, Tsagarakis NG, et al. Yaw moment compensation for bipedal robots via intrinsic angular momentum constraint. Int J Humanoid Robotics 2012; 9(04): Luo X, Xia D, and Zhu C. Planning and control of biped robots with upper body. In: IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Daejeon, South Korea, 9 14 October 2016, pp IEEE. 24. Liu J and Urbann O. Bipedal walking with dynamic balance that involves three-dimensional upper body motion. Robotics Auton Syst 2016; 77: Kuindersma S, Grupen R, and Barto A. Learning dynamic arm motions for postural recovery. In: IEEE-RAS International Conference on Humanoid Robots, Bled, Slovenia, October 2011, pp IEEE. 26. Sobajima M, Kobayashi T, Sekiyama K, et al. Bipedal walking control of humanoid robots by arm-swing. In: SICE Annual Conference, Nagoya Japan, September 2013, pp IEEE. 27. Kobayashi T, Sekiyama K, Aoyama T, et al. Selection of two arm-swing strategies for bipedal walking to enhance both stability and efficiency. Adv Robotics 2016; 30(6): Englsberger J and Ott C. Integration of vertical com motion and angular momentum in an extended capture point tracking controller for bipedal walking. In: IEEE-RAS International Conference on Humanoid Robots, Osaka, Japan, 29 November 1 December 2012, pp IEEE. 29. Chang CH, Huang HP, Hsu HK, et al. Humanoid robot pushrecovery strategy based on CMP criterion and angular momentum regulation. In: IEEE International Conference on Advanced Intelligent Mechatronics (AIM), 2015, Liu CJ, Xu T, Wang DW, et al. Active balance of humanoids with foot positioning compensation and non-parametric adaptation. Robotics Auton Syst 2016; 75: Xu T, Chen Q, and Cai Z. Rebalance strategies for humanoids walking by foot positioning compensator based on adaptive heteroscedastic SpGPs. In: IEEE International Conference on Robotics and Automation (ICRA), 2011, pp Castano JA, Li Z, Zhou C, et al. Dynamic and reactive walking for humanoid robots based on foot placement control. Int J Human Robot 2016; 13(02): Diedam H, Dimitrov D, Wieber PB, et al. Online walking gait generation with adaptive foot positioning through linear model predictive control. In: IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), 2008, pp Wieber PB. Trajectory free linear model predictive control for stable walking in the presence of strong perturbations. In: IEEE-RAS International Conference on Humanoid Robots, Genova, Italy, 4 6 December 2006, pp IEEE. 35. Nishiwaki K and Kagami S. Strategies for adjusting the ZMP reference trajectory for maintaining balance in humanoid walking. In: IEEE International Conference on Robotics and Automation (ICRA), Anchorage, AK, 3 7 May 2010, pp IEEE. 36. Lee BJ, Stonier D, Kim YD, et al. Modifiable walking pattern of a humanoid robot by using allowable ZMP variation. IEEE Trans on Robot 2008; 24(4): Hashimoto K, Sawato T, Hayashi A, et al. Avoidance behavior from external forces for biped vehicle. In: IEEE International Conference on Robotics and Automation (ICRA), Anchorage, AK, 3 7 May 2010, pp IEEE. 38. Stephens B. Integral control of humanoid balance. In: IEEE/ RSJ International Conference on Intelligent Robots and Systems (IROS), San Diego, CA, 29 October 2 November 2007, pp IEEE. 39. Liu C and Atkeson CG. Standing balance control using a trajectory library. In: IEEE/RSJ International Conference on Intelligent Robots and Systems, St. Louis, MO, October 2009, pp IEEE. 40. Graf C and Röfer T. A closed-loop 3D-LIPM gait for the RoboCup standard platform league humanoid. In: Proceedings of the Fifth Workshop on Humanoid Soccer Robots, 2010, pp Urbann O and Hofmann M. A reactive stepping algorithm based on preview controller with observer for biped robots. In: IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Korea, 9 14 October 2016, pp Daejeon Convention Center. 42. Gottschalk S. Separating axis theorem. Technical report, Technical Report TR96-024, Department of Computer Science, UNC Chapel Hill, 1996.

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

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

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

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

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

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

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

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

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

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

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

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

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

A NEW GOLF-SWING ROBOT MODEL UTILIZING SHAFT ELASTICITY

A NEW GOLF-SWING ROBOT MODEL UTILIZING SHAFT ELASTICITY Journal of Sound and Vibration (1998) 17(1), 17 31 Article No. sv981733 A NEW GOLF-SWING ROBOT MODEL UTILIZING SHAFT ELASTICITY S. SUZUKI Department of Mechanical System Engineering, Kitami Institute of

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

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

ZIPWAKE DYNAMIC TRIM CONTROL SYSTEM OUTLINE OF OPERATING PRINCIPLES BEHIND THE AUTOMATIC MOTION CONTROL FEATURES

ZIPWAKE DYNAMIC TRIM CONTROL SYSTEM OUTLINE OF OPERATING PRINCIPLES BEHIND THE AUTOMATIC MOTION CONTROL FEATURES ZIPWAKE DYNAMIC TRIM CONTROL SYSTEM OUTLINE OF OPERATING PRINCIPLES BEHIND THE AUTOMATIC MOTION CONTROL FEATURES TABLE OF CONTENTS 1 INTRODUCTION 3 2 SYSTEM COMPONENTS 3 3 PITCH AND ROLL ANGLES 4 4 AUTOMATIC

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

Author s Name Name of the Paper Session. Positioning Committee. Marine Technology Society. DYNAMIC POSITIONING CONFERENCE September 18-19, 2001

Author s Name Name of the Paper Session. Positioning Committee. Marine Technology Society. DYNAMIC POSITIONING CONFERENCE September 18-19, 2001 Author s Name Name of the Paper Session PDynamic Positioning Committee Marine Technology Society DYNAMIC POSITIONING CONFERENCE September 18-19, 2001 POWER PLANT SESSION A New Concept for Fuel Tight DP

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

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

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

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

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

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

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

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

SHUFFLE TURN OF HUMANOID ROBOT SIMULATION BASED ON EMG MEASUREMENT

SHUFFLE TURN OF HUMANOID ROBOT SIMULATION BASED ON EMG MEASUREMENT SHUFFLE TURN OF HUMANOID ROBOT SIMULATION BASED ON EMG MEASUREMENT MASANAO KOEDA, TAKAYUKI SERIZAWA, AND YUTA MATSUI Osaka Electro-Communication University, Faculty of Information Science and Arts, Department

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

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

INCLINOMETER DEVICE FOR SHIP STABILITY EVALUATION

INCLINOMETER DEVICE FOR SHIP STABILITY EVALUATION Proceedings of COBEM 2009 Copyright 2009 by ABCM 20th International Congress of Mechanical Engineering November 15-20, 2009, Gramado, RS, Brazil INCLINOMETER DEVICE FOR SHIP STABILITY EVALUATION Helena

More information

Kinematic Differences between Set- and Jump-Shot Motions in Basketball

Kinematic Differences between Set- and Jump-Shot Motions in Basketball Proceedings Kinematic Differences between Set- and Jump-Shot Motions in Basketball Hiroki Okubo 1, * and Mont Hubbard 2 1 Department of Advanced Robotics, Chiba Institute of Technology, 2-17-1 Tsudanuma,

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

The Incremental Evolution of Gaits for Hexapod Robots

The Incremental Evolution of Gaits for Hexapod Robots The Incremental Evolution of Gaits for Hexapod Robots Abstract Gait control programs for hexapod robots are learned by incremental evolution. The first increment is used to learn the activations required

More information

Variable Face Milling to Normalize Putter Ball Speed and Maximize Forgiveness

Variable Face Milling to Normalize Putter Ball Speed and Maximize Forgiveness Proceedings Variable Face Milling to Normalize Putter Ball Speed and Maximize Forgiveness Jacob Lambeth *, Dustin Brekke and Jeff Brunski Cleveland Golf, 5601 Skylab Rd. Huntington Beach, CA 92647, USA;

More information

beestanbul RoboCup 3D Simulation League Team Description Paper 2012

beestanbul RoboCup 3D Simulation League Team Description Paper 2012 beestanbul RoboCup 3D Simulation League Team Description Paper 2012 Baris Demirdelen, Berkay Toku, Onuralp Ulusoy, Tuna Sonmez, Kubra Ayvaz, Elif Senyurek, and Sanem Sariel-Talay Artificial Intelligence

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

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

Trajectory Planning and Motion Simulation for a Hydraulic Actuated Biped Robot

Trajectory Planning and Motion Simulation for a Hydraulic Actuated Biped Robot Research Journal of Applied Sciences, Engineering and Technology 5(0): 3004-3009, 203 ISSN: 2040-7459; e-issn: 2040-7467 Maxwell Scientific Organization, 203 Submitted: September 6, 202 Accepted: November

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

The Design and Control of a Bipedal Robot with Sensory Feedback

The Design and Control of a Bipedal Robot with Sensory Feedback International Journal of Advanced Robotic Systems ARTICLE The Design and Control of a Bipedal Robot with Sensory Feedback Regular Paper Teck-Chew Wee 1,*, Alessandro Astolfi 1 and Xie Ming 2 1 Department

More information

INSTANTANEOUS ON-LINE MODIFICATION OF BIPED WALK COMPOSED FROM RECONFIGURABLE ADAPTIVE MOTION PRIMITIVES

INSTANTANEOUS ON-LINE MODIFICATION OF BIPED WALK COMPOSED FROM RECONFIGURABLE ADAPTIVE MOTION PRIMITIVES THERMAL SCIENCE: Year 26, Vol. 2, Suppl. 2, pp. S53-S523 S53 INSTANTANEOUS ON-LINE MODIFICATION OF BIPED WALK COMPOSED FROM RECONFIGURABLE ADAPTIVE MOTION PRIMITIVES Introduction by Branislav A. BOROVAC

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

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

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

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

Implementing Provisions for Art. 411 of the ICR Ski Jumping

Implementing Provisions for Art. 411 of the ICR Ski Jumping JUMPING HILLS CONSTRUCTION NORM 2018 Implementing Provisions for Art. 411 of the ICR Ski Jumping Author: Hans-Heini Gasser (SUI) EDITION NOVEMBER 2018 Table of Contents Page 1. Preliminary Remarks 3 2.

More information

Analysis and realization of synchronized swimming in URWPGSim2D

Analysis and realization of synchronized swimming in URWPGSim2D International Conference on Manufacturing Science and Engineering (ICMSE 2015) Analysis and realization of synchronized swimming in URWPGSim2D Han Lu1, a *, Li Shu-qin2, b * 1 School of computer, Beijing

More information

Generation of Robot Motion Based on Measurement of Human Movement. Susumu Sakano 1, Satoru Shoji 1

Generation of Robot Motion Based on Measurement of Human Movement. Susumu Sakano 1, Satoru Shoji 1 Generation of Robot Motion Based on Measurement of Human Movement Susumu Sakano 1, Satoru Shoji 1 1College of Engineering, Nihon University 1 Nakagawara Tokusada Tamura-machi Koriyama 963-8642 Japan Tel;

More information

Influence of the swing ankle angle on walking stability for a passive dynamic walking robot with flat feet

Influence of the swing ankle angle on walking stability for a passive dynamic walking robot with flat feet Special Issue Article Influence of the swing ankle angle on walking stability for a passive dynamic walking robot with flat feet Advances in Mechanical Engineering 016, Vol. 8(3) 1 13 Ó The Author(s) 016

More information

CS 4649/7649 Robot Intelligence: Planning

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

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

ON PASSIVE MOTION OF THE ARMS FOR A WALKING PLANAR BIPED

ON PASSIVE MOTION OF THE ARMS FOR A WALKING PLANAR BIPED ON PASSIVE MOTION OF THE ARMS FOR A WALKING PLANAR BIPED Bassel Kaddar, Yannick Aoustin, Christine Chevallereau To cite this version: Bassel Kaddar, Yannick Aoustin, Christine Chevallereau. ON PASSIVE

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

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

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

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

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

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

Research on Goods and the Ship Interaction Based on ADAMS

Research on Goods and the Ship Interaction Based on ADAMS Research on Goods and the Ship Interaction Based on ADAMS Fangzhen Song, Yanshi He and Haining Liu School of Mechanical Engineering, University of Jinan, Jinan, 250022, China Abstract. The equivalent method

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

ITTC Recommended Procedures and Guidelines

ITTC Recommended Procedures and Guidelines Page 1 of 6 Table of Contents 1. PURPOSE...2 2. PARAMETERS...2 2.1 General Considerations...2 3 DESCRIPTION OF PROCEDURE...2 3.1 Model Design and Construction...2 3.2 Measurements...3 3.5 Execution of

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

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

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

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

Application of pushover analysis in estimating seismic demands for large-span spatial structure

Application of pushover analysis in estimating seismic demands for large-span spatial structure 28 September 2 October 2009, Universidad Politecnica de Valencia, Spain Alberto DOMINGO and Carlos LAZARO (eds.) Application of pushover analysis in estimating seismic demands for large-span spatial structure

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

Fail Operational Controls for an Independent Metering Valve

Fail Operational Controls for an Independent Metering Valve Group 14 - System Intergration and Safety Paper 14-3 465 Fail Operational Controls for an Independent Metering Valve Michael Rannow Eaton Corporation, 7945 Wallace Rd., Eden Prairie, MN, 55347, email:

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

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

AFRL-RI-RS-TR

AFRL-RI-RS-TR AFRL-RI-RS-TR-2014-045 ROBUST ROBOT CONTROL USING MULTIPLE MODEL-BASED POLICY OPTIMIZATION AND FAST VALUE FUNCTION-BASED PLANNING CARNEGIE MELLON UNIVERSITY MARCH 2014 FINAL TECHNICAL REPORT APPROVED FOR

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

Abstract. 1 Introduction

Abstract. 1 Introduction A computational method for calculatingthe instantaneous restoring coefficients for a ship moving in waves N. El-Simillawy College of Engineering and Technology, Arab Academyfor Science and Technology,

More information

Computer Aided Drafting, Design and Manufacturing Volume 26, Number 2, June 2016, Page 53. The design of exoskeleton lower limbs rehabilitation robot

Computer Aided Drafting, Design and Manufacturing Volume 26, Number 2, June 2016, Page 53. The design of exoskeleton lower limbs rehabilitation robot Computer Aided Drafting, Design and Manufacturing Volume 26, Number 2, June 2016, Page 53 CADDM The design of exoskeleton lower limbs rehabilitation robot Zhao Xiayun 1, Wang Zhengxing 2, Liu Zhengyu 1,3,

More information

Ranger Walking Initiation Stephanie Schneider 5/15/2012 Final Report for Cornell Ranger Research

Ranger Walking Initiation Stephanie Schneider 5/15/2012 Final Report for Cornell Ranger Research 1 Ranger Walking Initiation Stephanie Schneider sns74@cornell.edu 5/15/2012 Final Report for Cornell Ranger Research Abstract I joined the Biorobotics Lab this semester to gain experience with an application

More information

Analysis and Research of Mooring System. Jiahui Fan*

Analysis and Research of Mooring System. Jiahui Fan* nd International Conference on Computer Engineering, Information Science & Application Technology (ICCIA 07) Analysis and Research of Mooring System Jiahui Fan* School of environment, North China Electric

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

IMO REVISION OF THE INTACT STABILITY CODE. Proposal of methodology of direct assessment for stability under dead ship condition. Submitted by Japan

IMO REVISION OF THE INTACT STABILITY CODE. Proposal of methodology of direct assessment for stability under dead ship condition. Submitted by Japan INTERNATIONAL MARITIME ORGANIZATION E IMO SUB-COMMITTEE ON STABILITY AND LOAD LINES AND ON FISHING VESSELS SAFETY 49th session Agenda item 5 SLF 49/5/5 19 May 2006 Original: ENGLISH REVISION OF THE INTACT

More information

Mobile Robots (Legged) (Take class notes)

Mobile Robots (Legged) (Take class notes) Mobile Robots (Legged) (Take class notes) Legged mobile robots Mobile robots are robots which can move There are two types of mobile robots - Legged two, four, six and eight legs - Wheeled one, two, three

More information

Compliance Control for Biped Walking on Rough Terrain

Compliance Control for Biped Walking on Rough Terrain Compliance Control for Biped Walking on Rough Terrain Masaki Ogino 1,2, Hiroyuki Toyama 2 Sawa Fuke 1,2, Norbert Michael Mayer 1,2, Ayako Watanabe 2, and Minoru Asada 1,2 1 JST ERATO Asada Project, Yamada-oka

More information

Optimal Gait Primitives for Dynamic Bipedal Locomotion

Optimal Gait Primitives for Dynamic Bipedal Locomotion 2012 IEEE/RSJ International Conference on Intelligent Robots and Systems October 7-12, 2012. Vilamoura, Algarve, Portugal Optimal Gait Primitives for Dynamic Bipedal Locomotion Bokman Lim, Jusuk Lee, Joohyung

More information

DYNAMIC POSITIONING CONFERENCE October 7-8, New Applications. Dynamic Positioning for Heavy Lift Applications

DYNAMIC POSITIONING CONFERENCE October 7-8, New Applications. Dynamic Positioning for Heavy Lift Applications Return to Session Directory DYNAMIC POSITIONING CONFERENCE October 7-8, 2008 New Applications Dynamic Positioning for Heavy Lift Applications John Flint and Richard Stephens Converteam UK Ltd. (Rugby,

More information

Development of a Locomotion and Balancing Strategy for Humanoid Robots

Development of a Locomotion and Balancing Strategy for Humanoid Robots University of Denver Digital Commons @ DU Electronic Theses and Dissertations Graduate Studies 1-1-2018 Development of a Locomotion and Balancing Strategy for Humanoid Robots Emile Bahdi University of

More information

HUMANOID robots involve many technical issues to be

HUMANOID robots involve many technical issues to be IEEE TRANSACTIONS ON ROBOTICS, VOL. 21, NO. 5, OCTOBER 2005 977 Sensory Reflex Control for Humanoid Walking Qiang Huang and Yoshihiko Nakamura, Member, IEEE Abstract Since a biped humanoid inherently suffers

More information

A Chiller Control Algorithm for Multiple Variablespeed Centrifugal Compressors

A Chiller Control Algorithm for Multiple Variablespeed Centrifugal Compressors Purdue University Purdue e-pubs International Compressor Engineering Conference School of Mechanical Engineering 2014 A Chiller Control Algorithm for Multiple Variablespeed Centrifugal Compressors Piero

More information

Neuro-Fuzzy ZMP Control of a Biped Robot

Neuro-Fuzzy ZMP Control of a Biped Robot Proceedings of the 6th WSEAS International Conference on Simulation, Modelling and Optimization, Lisbon, Portugal, September 22-24, 26 331 Neuro-Fuzzy ZMP Control of a Biped Robot JOÃO PAULO FERREIRA (1)

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

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

Quadratic Encoding of Optimized Humanoid Walking

Quadratic Encoding of Optimized Humanoid Walking Quadratic Encoding of Optimized Humanoid Walking Junggon Kim, Nancy S. Pollard and Christopher G. Atkeson Abstract In this paper we show that optimal stepping trajectories and trajectory cost for a walking

More information

EVOLVING HEXAPOD GAITS USING A CYCLIC GENETIC ALGORITHM

EVOLVING HEXAPOD GAITS USING A CYCLIC GENETIC ALGORITHM Evolving Hexapod Gaits Using a Cyclic Genetic Algorithm Page 1 of 7 EVOLVING HEXAPOD GAITS USING A CYCLIC GENETIC ALGORITHM GARY B. PARKER, DAVID W. BRAUN, AND INGO CYLIAX Department of Computer Science

More information

Research on Small Wind Power System Based on H-type Vertical Wind Turbine Rong-Qiang GUAN a, Jing YU b

Research on Small Wind Power System Based on H-type Vertical Wind Turbine Rong-Qiang GUAN a, Jing YU b 06 International Conference on Mechanics Design, Manufacturing and Automation (MDM 06) ISBN: 978--60595-354-0 Research on Small Wind Power System Based on H-type Vertical Wind Turbine Rong-Qiang GUAN a,

More information

AIS data analysis for vessel behavior during strong currents and during encounters in the Botlek area in the Port of Rotterdam

AIS data analysis for vessel behavior during strong currents and during encounters in the Botlek area in the Port of Rotterdam International Workshop on Next Generation Nautical Traffic Models 2013, Delft, The Netherlands AIS data analysis for vessel behavior during strong currents and during encounters in the Botlek area in the

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

Development of a Simulation Model for Swimming with Diving Fins

Development of a Simulation Model for Swimming with Diving Fins Proceedings Development of a Simulation Model for Swimming with Diving Fins Motomu Nakashima 1, *, Yosuke Tanno 2, Takashi Fujimoto 3 and Yutaka Masutani 3 1 Department of Systems and Control Engineering,

More information

Modeling of Hydraulic Hose Paths

Modeling of Hydraulic Hose Paths Mechanical Engineering Conference Presentations, Papers, and Proceedings Mechanical Engineering 9-2002 Modeling of Hydraulic Hose Paths Kurt A. Chipperfield Iowa State University Judy M. Vance Iowa State

More information

Simulation and mathematical modeling for racket position and attitude of table tennis

Simulation and mathematical modeling for racket position and attitude of table tennis Acta Technica 62 No. 3A/2017, 135 142 c 2017 Institute of Thermomechanics CAS, v.v.i. Simulation and mathematical modeling for racket position and attitude of table tennis Jiansi Song 1 Abstract. Racket

More information

Evolving Gaits for the Lynxmotion Hexapod II Robot

Evolving Gaits for the Lynxmotion Hexapod II Robot Evolving Gaits for the Lynxmotion Hexapod II Robot DAVID TOTH Computer Science, Worcester Polytechnic Institute Worcester, MA 01609-2280, USA toth@cs.wpi.edu, http://www.cs.wpi.edu/~toth and GARY PARKER

More information