Robust Vertical Ladder Climbing and Transitioning between Ladder and Catwalk for Humanoid Robots

Size: px
Start display at page:

Download "Robust Vertical Ladder Climbing and Transitioning between Ladder and Catwalk for Humanoid Robots"

Transcription

1 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS) Congress Center Hamburg Sept 8 - Oct,. Hamburg, Germany Robust Vertical Ladder Climbing and Transitioning between Ladder and Catwalk for Humanoid Robots Masao Kanazawa, Shunichi Nozawa, Yohei Kakiuchi, Yoshiki Kanemoto, Mitsuhide Kuroda, Kei Okada, Masayuki Inaba, Takahide Yoshiike Abstract This paper presents a novel control method to stabilize the whole-body motion of humanoid robots when climbing vertical ladders and transitioning between ladders and catwalks. In such environments, the body of the robot tends to incline and rotate because of the slippery surfaces. The inclination and rotation may cause the robot to fail to grasp and thus collide with the rungs. The proposed method modifies the subsequent contact position in real time based on the error of the current robot posture estimated with inertial measurement units (IMUs) and actual joint angles. This paper also presents a method of generating motion by minimizing the contact wrench. This method satisfies hardware limitations, such as collision avoidance, joint torque limits, and joint limits. Applying these methods to a humanoid robot, we realize the robust climbing and descending of multiple rungs of a vertical ladder and bidirectional transitioning from ladders to catwalks. I. INTRODUCTION Recently, humanoid robots have been expected to travel in environments designed for humans during the inspection or maintenance of social infrastructures, such as factories and power plants. In particular, climbing and descending ladders and transitioning between ladders and catwalks are necessary for activities in such places. It is difficult for a humanoid robot to climb a ladder because the motion of the robot must simultaneously satisfy various constraints, including joint angle limit, joint torque limit, balancing, avoiding collisions, and compensating for friction [], []. Noda et al. performed an experiment on stepladder climbing based on iterative motion optimization at key poses [3]. In the DARPA Robotics Challenge, several teams have also presented stepladder-climbing robots [4], []. However, climbing vertical ladders is more challenging than climbing stepladders because the weak frictional force makes the robot likely to slip on the rung and the horizontal component of the center of gravity (COG) position always exceed the support polygon made by its feet. In particular, an actual motion tends to deviate from a designed motion when gripping with one hand. This deviation causes the robot to fail to grasp the next rung and eventually results in the robot falling from the ladder. Vaillant et al. [6] experimented with a robot climbing a vertical ladder. In their experiment, the gripper position was adjusted by an operator located behind the robot because the robot lacked a firm grasp. An error between the actual and designed motions caused by Fundamental Research Center, Honda Research & Development, 8- Honcho, Wako-shi, Saitama, Japan. Department of Mechano-Infomatics, The University of Tokyo, 7-3- Hongo, Bunkyo-ku, Tokyo, Japan Fig.. Vertical ladder climbing (left) and transitioning between a ladder and a catwalk (right) mechanical compliance is inherent and unavoidable because of translational and rotational errors, including joint position error, compliance, or insufficient grasping force to climb ladders. Therefore, robots must be able to compensate for this error to continue climbing. Similar problems exist when the robot makes transition between a ladder and a catwalk. When making this transition, the robot tends to rotate around the edge of the support polygon if the hands cannot provide the appropriate contact force and moment to maintain its balance, because the horizontal components of the COG position usually exceed the support polygon. In this case, the robot s feet may slip on the rung, causing the robot to collide with or fall from the ladder. Because of these problems, humanoid hardware capable of transitioning between a ladder and a catwalk has not yet been developed. In this paper, we propose a novel control method to modify the subsequent contact position according to the current estimated robot posture in real time. We realize robust multiplerung vertical ladder climbing and bidirectional transitioning from a ladder to a catwalk by humanoid robot hardware using the proposed control method and a complementary motion generation method. The proposed motion generation method satisfies the various constraints described above. The following section gives an overview of the proposed system. The motion generation method is explained in Sections III and IV, and the stabilizing control is explained in Section V. Section VI presents the experimental results //$3. IEEE

2 II. OVERVIEW OF PROPOSED SYSTEM Our system consists of two primary modules that perform offline motion generation and real-time motion control, as shown in Fig.. The motion generation module outputs motion that satisfies the joint and torque constraints and avoids both collisions with the environment and self-collisions under the constraints of the frictional forces between each rung of the ladder and the robot s feet. Here, the motion of the robot is defined as the trajectories of the joints, the trajectory of the base link, and the contact wrenches, which are the wrenches at the contact points. Using this definition, the robot can execute the designed motion. The motion control module directs the robot to follow a motion generated offline in real time. In the motion generation module, the motion is generated in the following sequence. ) Target contact point generation: Target contact points are predefined in the environmental geometry model. A sequence of contact points corresponding to a robot crawl climbing a ladder is shown in Fig.3. ) Trajectory interpolation: End-effector trajectories are generated by interpolating the target contact points and waypoints. Waypoints are defined for the robot s hands and feet based on the direction of approach. 3) Whole-body joints and base link trajectories generation: Based on the target contact points, the key-frame target COG positions are determined, and the target COG trajectories are then obtained by interpolation. In Section III, whole-body joints and base link trajectories generation is explained in detail. 4) Contact wrench distribution by optimization: All inertial forces are calculated from inverse dynamics based on the joints and the base link trajectories. The contact wrenches of the end-effectors are then obtained from optimization considering contact constraints, such as a friction cone. In Section IV, contact wrench trajectory generation is explained in detail. ) Stability control: The robot essentially follows the designed trajectories of the base posture, joint angles, and contact wrench. The designed joint angles that are sent to the robot are modified in real time by the stability control based on sensors, such as force/torque sensors and inertial measurement units (IMUs). III. WHOLE-BODY JOINTS AND BASE LINK TRAJECTORIES GENERATION To generate motion that satisfies various constraints, such as joint angle and joint velocity limits, we formulate the problem as a quadratic programming (QP) problem with inequality constraints. The objective function and the inequality constraints of the QP problems are min q q T W a q + k (ẋ k J k q) T W k (ẋ k J k q) () s.t. q q q + () ẋ col J col q, (3) where q R 6+N D.O.F. is the generalized velocity vector and includes the joint, base link, and angular velocities; ẋ k Fig.. Fig. 3. Gait Parameters (Number of steps; gait pattern, stab.: modified reference by stability control e.g., crawl, pace, trot) Motion generation Target contact point generation Contact points Trajectory interpolation Stability control End-effector Momentum Body posture trajectory Whole-body trajectory generation Base posture reference Joint angle reference Contact wrench distribution Base posture reference Joint angle reference Contact wrench reference Joint angle stab. Hardware Motion control Overview of system for motion generation and control Sequence of target contact points (red) on ladder is a generalized velocity vector in the task space; J k is a Jacobian; W a is a weight matrix for the joint velocity; and W k is a weight matrix for the tasks. The second term of Equation () describes the minimization of the errors of the equality constraints in the task space. The definitions of these constraints are listed in the following subsections. Equation () corresponds to the joint and joint velocity constraints, and Equation (3) corresponds to self-collision and robot environment collision avoidance constraints [7]. A. End-effector constraints Target end-effector trajectories should be tracked accurately to avoid collisions with environmental objects, such as ladder rungs. The velocities of the end-effectors must satisfy the constraint ẋ E = J E q, (4) where ẋ E is the target velocity vector of the end-effectors and J E is the Jacobian of the end-effector velocities. When using velocity constraints, the end-effector positions contain numerical errors. Therefore, the target velocity vector is generated by using proportional control to follow the desired end-effector trajectories. B. COG velocity constraints To satisfy the kinematic constraints, we use an additional constraint to follow the COG trajectory. The COG trajectory 3

3 Fig. 4. The frame of the robot (red: x-axis, green: y-axis, blue: z-axis) is used instead of the base link trajectory to ensure the total inertial force is smooth. To generate the COG trajectory, the COG sequence at key poses is calculated by averaging the positions of all contact points and then adding a predefined offset. The COG is then interpolated with a minimum jerk model. Because of the numerical error, proportional control is also used to follow the COG trajectory. The COG velocities must satisfy the constraint [8], [9]. where J g is the COG Jacobian. C. Base link orientation constraints ẋ g = J g q, () To satisfy the joint limits, the base link orientation is constrained around the x- and y-axes by the selection matrix S x,y, which is given by S x,y ẋ r = S x,y J r q (6) [ ] S x,y =, (7) where J r is the Jacobian for the base link angular velocity. The frame of robot is shown in Fig.4. Because we employ q R 6+N D.O.F., as mentioned in (), we can formulate the base link angular velocity like the joint space velocity. We assume that the base link is set to the root of the link chains, which is a pelvis link in the case of a typical humanoid robot. D. Angular momentum constraints For the transition between a ladder and a catwalk, the rotational error of the base link around the yaw axis is considered critical because it results in the robot s failure to grasp. To maintain an angular momentum of zero about the yaw axis, the following constraint to the selection matrix S z must be satisfied: S z ẋ l = S z J l q, (8) where J l is the angular momentum Jacobian [8], [9]. The inverse kinematics are calculated using this method. The calculated joint and base link velocities satisfy the joint angle and joint angle velocity constraints while tracking the end-effector position and orientation, COG position, base link orientation around the roll and pitch axes, and angular momentum around the yaw axis. The joint angles and the base link position and orientation are calculated by integrating the velocity trajectory. IV. CONTACT WRENCH DISTRIBUTION A. Inverse dynamics calculation of whole-body inertial wrench The whole-body inertial wrench is calculated using inverse dynamics as [] [ ] [ ] ] [ ] M M = b + τ M M [ qb θ b Σ k [ J T k, J T k, J T k, J T k, ] [ fk n k ], (9) where M ii is the generalized inertia matrix, b i is the generalized bias force (gravitational force and Coriolis forces), J k,ii is the Jacobian of the contact point for kth limb, f k, n k are the contact forces and moments, respectively, q B is acceleration of base link, θ are joint angles, τ are joint torques. Assuming that the contact wrenches of all limbs are zero, the whole-body inertial wrench w B can be obtained as [ ] [ ] [ ] wb M M τ = b +, () M M ] [ qb θ where τ is the modified joint torques. B. Distribution of whole-body inertial wrench by quadratic programming In Equation (), we assume that the contact wrenches of all feet and hands are zero but instead obtain w B, which is the whole-body inertial wrench applied to the base link. In practice, the whole-body inertial wrench should be balanced with the contact wrenches, and the total wrench applied to the base link should be zero. While determining the distribution of the whole-body inertial wrench, constraints of the contact condition and joint torque limits must be satisfied. We formulate this constrained inverse dynamics problem as a QP problem as follows: min w all wall T W wrw all + τ T W trq τ () s.t. G all w all = w B () b C all w all (3) τ min τ τ max, (4) where W wr and W trq are the weight matrices of the wrenches and joint torques, respectively; τ min and τ max are the minimum and maximum torque limits, respectively; and w all R 6N L is the contact wrenches of all limbs with N L representing the number of contact limbs. w all = [ wc,, T, wc,i T,, wt c,n L ] T () Equation () shows the distribution of the whole-body inertial wrench. G all R 6 6N L shows the equality matrix of the contact wrench: [ ]... E3... G all w all = w... p c,i E 3... all, (6) where p c,i is the outer product matrix of p c,i, which is the position of the ith contact point. 4

4 Considering wrenches at contact points (p c,z = ), we obtain p cop,x = p c,x f c,z n c,y f c,z () p cop,y = p c,y f c,z + n c,x f c,z. (3) Fig.. Frame of hand (left) and foot (right) Equation (3) shows the constraints of the contact conditions, which are C all w all = diag(c c,i R 6,c,i )w all, (7) where R 6,c,i R 6 6 is a transformation matrix from contact coordinates to the fixed environment coordinates. [ ] Rc,i R 6,c,i = (8) R c,i The contact constraint C c,i is described in the following section. Note that the decoupling of the motion generation into Equations () and () does not guarantee that the obtained motion is feasible. For example, when calculating Equation () after Equation (), we may not find the optimal solution of Equation (). To confront this problem in our approach, we use a heuristic rule to modify the key pose COG sequence such that it satisfies the dynamics constraints. C. Contact conditions When calculating the contact constraint C c,i, we employ local contact coordinates to determine the contact constraint matrices at each contact point. We consider plane and line contacts at the foot and a gripper contact at the hand, as shown in Fig.. For the plane contact, we define the z-axis as the component normal to the contact plane and the x- and y-axes as the components tangential to the contact plane. We consider four contact conditions as follows. The wrench expressed in the contact coordinates is w c = [f T c n T c ] T, f c = [f c,x f c,y f c,z ] T, and n c = [n c,x n c,y n c,z ] T, where the moment n c is defined with respect to the contact point p c. Unilateral constraint: Frictional cone: f c,z. (9) f c,[x,y] µ t f c,z. () Rotational friction around z-axis: n c,z µ r f c,z, () where µ t and µ r are the translational and rotational friction coefficients, respectively. Center of pressure (COP) constraint The condition that the COP is inside a rectangular area with principal axes aligned with the coordinates of the contact point is described as l min,[x,y] p cop,[x,y] l max,[x,y]. (4) We model the contact between the feet and the rung as a line contact. For the line contact, we set several COP margins in (4) to zero because the COP is limited on the line. For example, when the line is oriented along the y-axis, we set l min,x = l max,x =. For the plane or line contact of the foot, we can calculate the following contact matrix: C c,i = [ C T uni,z, CT tfic,x, CT tfic,y, CT rfic,z, CT cop,x, C T cop,y ] T i, () where C uni,z, C tfic,[x,y], C rfic,z, and C cop,[x,y] are calculated from Equations (9), (), (), and (4), respectively. For the gripper contact of the hand, we approximately use the following contact matrix instead of detailed nonlinear constraints: C c,i = [ C T uni,z, CT tfic,y, CT rfic,y, CT cop,x V. STABILITY CONTROL ] T i (6) If the robot can accurately trace the motion generated using the method shown in Sections III and IV, the robot would be able to climb and descend a ladder. However, a humanoid robot often deviates from designed motion because of mechanical compliance, including joint position error or lack of a firm grasp. The rotation error should be considered while the robot ascends a vertical ladder. We have proposed a novel control algorithm that decreases the rotation error in real time by modifying the position of the end-effector according to the estimated robot posture and actual joint angles. Fig.6 provides an overview of the stability control algorithm. The stability controller consists of three components: a limb compliance controller, a robot posture estimator, and a real-time footstep position controller. A. Limb compliance controller The limb compliance controller regulates the contact wrench for each limb. This control suppresses excessive joint torque caused by internal forces among the limbs. To reduce high-frequency inputs to the force/torque sensors, the soles and grippers of the robot are equipped with rubber bushes.

5 B. Robot posture estimator In this section, we propose a robot posture estimator that can estimate the positions and orientations of the contact points and the base link. Rotational and translational errors occur due to mechanical compliance, joint position error, and slippage of the feet. The purpose of the robot posture estimator is to estimate these rotational and translational errors. The overall flow of the estimation method is shown in Fig.7, and the parameters of the estimator are listed in Table I. First, the orientation of the base link Rbase estm is estimated by inertial navigation with an accelerometer and a gyroscope. Next, the positions and orientations of the end-effectors are calculated by forward kinematics using actual joint angles measured by encoders, the orientation of the base link estimated by inertial navigation, and the translation of the base link previously estimated by the robot posture estimator: (x estm sup [k], R estm [k], x estm [k], R estm [k]) sup swg swg = F orward Kinematics(x estm base [k ], R estm base [k], θ act [k]). (7) Next, the estimator calculates the deflections of the elastic mechanical elements, such as rubber brushes, attached to the end-effectors. The contact points are estimated as x estm sup [k] = x estm sup [k] K f f sup [k] (8) R estm sup [k] = exp( K τ τ sup [k])rsup estm [k], (9) where K f and K τ are respectively the force and torque gains of the mechanical compliance of the end-effectors. The mechanical compliance is identified by measurement or structural calculation. The torque element of the mechanical compliance exp(k τ τ sup [k]) is represented with an exponential map []. To estimate the translation of the base link, we assume that the estimated contact points are close to the reference contact points. The estimator minimizes the sum of the estimation errors of all contact points. The estimation errors of the contact points can be calculated as the differences between the estimated contact points and the target contact points specified by the reference trajectory. The minimization is asymptotically achieved by subtracting the average errors of the contact points multiplied by feedback gain from the previous estimation of the translation of the base link, as x estm base [k] = x estm base [k ] K base n n i= (x estm sup,i [k] x ref sup,i [k]). (3) The positions and orientations of the base link and the endeffectors are estimated using this estimator. With appropriate feedback gain, discontinuities while changing contacts are suppressed. C. Footstep position controller The footstep position controller modifies the trajectories of the end-effectors of the limbs using the estimated contact Contact wrench reference Body posture reference Joint angle reference Whole robot trajectory Symbol ωgyro sens a sens gyro x estm base, Restm base x ref base, Rref base x sup/swg R sup/swg θ act f sup τ sup K base Joint angle Angular velocity Acceleration Robot posture estimator Footstep position controller Fig. 6. Fig. 7. End-effector modified stab. Robot Estimated body posture Estimated end-effector posture Contact wrench Limb compliance controller Inverse kinematics Controller overview Robot posture estimator TABLE I End-effector stab. Joint angle stab. stab.: modified reference by stability control PARAMETERS OF ROBOT POSTURE ESTIMATOR Fig. 8. Definition base link angular velocity from gyroscope base link linear acceleration from accelerometer estimated base link position/orientation reference base link position/orientation support/swing limb end-effector position support/swing limb end-effector orientation actual joint angle contact force of support limb from force sensor contact torque of support limb from torque sensor base link positional error feedback gain Schematic of footstep position controller point positions. The deviation of the limb trajectories causes the problems listed below. 6

6 X [m]. Y [m] Z [m]. Fig. 9. Fig.. Simulated base link position and orientation (green and blue lines almost overlap) E XPERIMENTAL HARDWARE SPECIFICATIONS Degrees of freedom Height Weight Leg Arm Hand Body Head Total.67 m 8 kg VI. E XPERIMENTAL RESULTS A. Experimental hardware We used an experimental robot to validate the algorithm. The configuration and major specifications of the robot are summarized in Fig.9 and Table II. The robot s trunk is equipped with pitch and yaw joints, which enable both bipedal and quadrupedal walking []. Its hands are designed for knuckle-walking and ladder climbing. The pelvis of the robot is assumed to be the base link. Robot fails to grasp or land on the rung. Shank of the robot hits the rung. To solve the first problem, the positions of the endeffectors are modified according to the estimated deviations of the positions of the swing limb end-effectors, as shown in Fig.8. The modifications are filtered by a low-pass filter to prevent oscillations caused by sensor noise: xswg = (xref xestm swg ). + T s swg (3) To solve the second problem, the deviation of the contact point is treated as slippage on the rung of the ladder when the limb is the supporting limb. To maintain the base link at the designed position, the position modification of the endeffector is calculated as xsup = (xref xestm sup ), + T s sup TABLE II Dimension estimated Experimental hardware simulated actual Yaw [deg] Pitch [deg] Roll [deg] designed (3) which means the robot stretches its leg to compensate for the slippage of support limbs. These modifications should be performed in real time to prevent a grasping or landing failure. The modifications should be constrained such that they do not exceed the joint angle limits. With these methods, the rotation and inclination of the robot do not diverge, and collisions against rungs can be avoided. B. Verification of robot posture estimator We verified the robot posture estimator using the rigid body simulator integrated with Open Dynamics Engine [3]. Fig. shows the results of the base link position and orientation estimation. Fig. shows the estimation error of them. The position estimation error is less than 9 mm. The orientation estimation errors are less than. deg. The results of this simulation show that the estimated position and orientation of the base link have sufficiently high accuracy. C. Effects of footstep position controller We evaluated the effects of the footstep position controller in two cases: vertical ladder climbing and transitioning between a ladder and a catwalk. Fig. compares the inclination error of the pitch axis with and without the footstep controller while climbing the vertical ladder. The inclination error is defined as the difference between the estimated and designed body link orientations. Without the footstep position controller, slippage of the foot occurs because the grasping point of the hand works like the pivot of a pendulum. After several steps, the inclination error reaches. deg, and the shank collides with the ladder. In contrast, with the controller, the inclination error does not diverge beyond. deg. The simulation results 7

7 X Y Z position error [mm] Roll Pitch Yaw. Fig.. The effects of the footstep position controller in simulation. The background color represents the swing phase of each limb...6 effector position X [m] rotational error [deg] demonstrate that the controller enables the robust climbing of multiple rungs without grasp failures or collisions. Fig.3 shows the results of simulating a transition from a ladder to a catwalk. We compare the proposed methods with and without the footstep position controller. Without the footstep position controller, the amount of slippage of the left foot is mm after the transitioning, and the shank of the left leg and the ladder may collide during the transition. In contrast, the slippage is. mm with the footstep position controller because the controller appropriately modified the footstep position. VII. C ONCLUSIONS In this paper, we propose a novel control method for the whole-body motion of a humanoid robot while climbing a 4 without footstep control with footstep control 4 6 Fig. 3. Simulated transition from a ladder to a catwalk Above figure: Left leg effector position X, Bottom figure: Left leg effector effector position X error, Right figure: Snapshot of robot when left leg is on the rung (s) and footstep controller is used. D. Real robot experiment. Pitch error [deg]. -. Yaw error [deg] The performance of the proposed controller and motion generator is verified through experiments with the humanoid robot. ) Ladder climbing: Fig. shows snapshots of the robot climbing four rungs of a vertical ladder. The distance between the rungs is.7 m, and the width of each rung is.4 m. The sequence of crawl climbing and descending four rungs takes 8 s. The inclination errors of the roll and pitch axes are less than.9 deg, and the inclination error of the yaw axes is less than. deg as shown in Fig.4. ) Transition between ladder and catwalk: Fig.6 shows snapshots of the humanoid robot transitioning between the ladder and the catwalk. In the experiment, the robot utilized the footstep position controller and could transition stably without collisions. designed. Simulated base link position and orientation estimation error with footstep control. effector position X error [mm] Fig.. Roll error [deg] without footstep control.4 - time[s] Fig. 4. Experimental base inclination error while climbing ladder vertical ladder and transitioning between ladders and catwalks. We have solved the issues of posture error caused by mechanical compliance at the feet and hand grippers, joint position error, and slippage of the feet. The proposed control method modifies the subsequent footstep position in real time according to the estimated current robot posture from IMUs and actual joint angles. 8

8 Fig.. Fig. 6. Snapshots of humanoid robot climbing ladder Snapshots of humanoid robot transitioning between ladder and catwalk We have also developed a motion generation method that minimizes contact wrenches while satisfying kinematic and contact constraints. With these methods, we realized robust continuous vertical ladder climbing and descending and bidirectional transitioning from ladders to catwalks with a human-sized humanoid robot. In this paper, ladder climbing was achieved with a crawl configuration. To design a robot that can climb ladders more rapidly, we plan to employ other gait patterns, such as trotting and pacing, in the future. R EFERENCES [] H. Yoneda, K. Sekiyama, Y. Hasegawa, and T. Fukuda, Vertical ladder climbing motion with posture control for multi-locomotion robot, in Proc. of the 8 IEEE/RSJ International Conference on Intelligent Robots and Systems. IEEE, 8, pp [] S. Kim, M. Spenko, S. Trujillo, B. Heyneman, V. Mattoli, and M. R. Cutkosky, Whole body adhesion: hierarchical, directional and distributed control of adhesive forces for a climbing robot, in Proc. of the 7 IEEE International Conference on Robotics and Automation. IEEE, 7, pp [3] S. Noda, M. Murooka, S. Nozawa, Y. Kakiuchi, K. Okada, and M. Inaba, Generating whole-body motion keep away from joint torque, contact force, contact moment limitations enabling steep climbing with a real humanoid robot, in Proc. of the 4 IEEE International Conference on Robotics and Automation. IEEE, 4, pp [4] G. Pratt and J. Manzo, The darpa robotics challenge [competitions], IEEE Robotics & Automation Magazine, vol., no., pp., 3. [] J. Luo, Y. Zhang, K. Hauser, H. A. Park, M. Paldhe, C. Lee, M. Grey, M. Stilman, J. H. Oh, J. Lee, et al., Robust ladder-climbing with a humanoid robot with application to the darpa robotics challenge, in Proc. of the 4 IEEE International Conference on Robotics and Automation. IEEE, 4, pp [6] J. Vaillant, A. Kheddar, H. Audren, F. Keith, S. Brossette, K. Kaneko, M. Morisawa, E. Yoshida, and F. Kanehiro, Vertical ladder climbing by the hrp- humanoid robot, in Proc. of 4th IEEE-RAS International Conference on Humanoid Robots. IEEE, 4, pp [7] F. Kanehiro, M. Morisawa, W. Suleiman, K. Kaneko, and E. Yoshida, Integrating geometric constraints into reactive leg motion generation, in Proc. of the IEEE/RSJ International Conference on Intelligent Robots and Systems,, pp [8] T. Sugihara and Y. Nakamura, Whole-body cooperative balancing of humanoid robot using cog jacobian, in Proc. of the IEEE/RSJ International Conference on Intelligent Robots and Systems, vol. 3. IEEE,, pp [9] S. Kajita, F. Kanehiro, K. Kaneko, K. Fujiwara, K. Harada, K. Yokoi, and H. Hirukawa, Resolved momentum control: Humanoid motion planning based on the linear and angular momentum, in Proc. of the 3 IEEE/RSJ International Conference on Intelligent Robots and Systems, vol.. IEEE, 3, pp [] K. Nagasaka, The whole-body motion generation of humanoid robot using dynamics filter, Ph.D. dissertation,. [] F. S. Grassia, Practical parameterization of rotations using the exponential map, Journal of graphics tools, vol. 3, no. 3, pp. 9 48, 998. [] T. Kamioka, T. Watabe, M. Kanazawa, H. Kaneko, and T. Yoshiike, Dynamic gait transition between bipedal and quadrupedal locomotion, in Proc. of the IEEE/RSJ International Conference on Intelligent Robots and Systems. IEEE,. [3] R. Smith, Open dynamics engine, 9

A sliding walk method for humanoid robots using ZMP feedback control

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

More information

Motion Planning of Ladder Climbing for Humanoid Robots

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

More information

Simplified Walking: A New Way to Generate Flexible Biped Patterns

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

More information

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

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

More information

Controlling Humanoid Robots with Human Motion Data: Experimental Validation

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

More information

A Walking Pattern Generator for Biped Robots on Uneven Terrains

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

More information

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

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

More information

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

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

More information

Motion Planning for Whole Body Tasks by Humanoid Robots

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

More information

Adaptive Motion Control: Dynamic Kick for a Humanoid Robot

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

More information

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

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

More information

A simple example. Assume we want to find the change in the rotation angles to get the end effector to G. Effect of changing s

A simple example. Assume we want to find the change in the rotation angles to get the end effector to G. Effect of changing s CENG 732 Computer Animation This week Inverse Kinematics (continued) Rigid Body Simulation Bodies in free fall Bodies in contact Spring 2006-2007 Week 5 Inverse Kinematics Physically Based Rigid Body Simulation

More information

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

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

More information

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

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

More information

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

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

More information

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

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

More information

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

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

More information

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

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

More information

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

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

More information

Dynamic State Estimation using Quadratic Programming

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

More information

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

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

More information

ROBOTICS 01PEEQW. Basilio Bona DAUIN Politecnico di Torino

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

More information

Modeling of Humanoid Systems Using Deductive Approach

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

More information

Written exams of Robotics 2

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

More information

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

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

More information

Serially-Linked Parallel Leg Design for Biped Robots

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

More information

AUTONOMOUS PLANETARY ROVER CONTROL USING INVERSE SIMULATION

AUTONOMOUS PLANETARY ROVER CONTROL USING INVERSE SIMULATION AUTONOMOUS PLANETARY ROVER CONTROL USING INVERSE SIMULATION Kevin Worrall (1), Douglas Thomson (1), Euan McGookin (1), Thaleia Flessa (1) (1)University of Glasgow, Glasgow, G12 8QQ, UK, Email: kevin.worrall@glasgow.ac.uk

More information

Integrating Dynamics into Motion Planning for Humanoid Robots

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

More information

Automatic Control Industrial robotics

Automatic Control Industrial robotics Automatic Control Industrial robotics Prof. Luca Bascetta (luca.bascetta@polimi.it) Politecnico di Milano Dipartimento di Elettronica, Informazione e Bioingegneria Prof. Luca Bascetta Industrial robots

More information

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

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

More information

FORCE CONTROL OF LINK SYSTEMS USING THE PARALLEL SOLUTION SCHEME

FORCE CONTROL OF LINK SYSTEMS USING THE PARALLEL SOLUTION SCHEME FORCE CONTROL OF LIN SYSTEMS USING THE PARALLEL SOLUTION SCHEME Daigoro Isobe Graduate School of Systems and Information Engineering, University of Tsukuba 1-1-1 Tennodai Tsukuba-shi, Ibaraki 35-8573,

More information

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

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

More information

Leg Motion Primitives for a Humanoid Robot to Imitate Human Dances

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

More information

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

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

More information

Development of a Ground Based Cooperating Spacecraft Testbed for Research and Education

Development of a Ground Based Cooperating Spacecraft Testbed for Research and Education DIPARTIMENTO DI INGEGNERIA INDUSTRIALE Development of a Ground Based Cooperating Spacecraft Testbed for Research and Education Mattia Mazzucato, Sergio Tronco, Andrea Valmorbida, Fabio Scibona and Enrico

More information

Modeling and kinematics simulation of freestyle skiing robot

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

More information

Humanoid Robotics. Path Planning and Walking. Maren Bennewitz

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

More information

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

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

More information

Robust Control of Bipedal Humanoid (TPinokio)

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

More information

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

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

More information

Balanced Walking with Capture Steps

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

More information

Singularity Handling on Puma in Operational Space Formulation

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

More information

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

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

More information

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

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

More information

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

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

More information

The Mathematical Model and Computer Simulation of a Quadruped Robot

The Mathematical Model and Computer Simulation of a Quadruped Robot Research Experience for Undergraduates 2014 Milwaukee School of Engineering National Science Foundation Grant June 1- August 8, 2014 The Mathematical Model and Computer Simulation of a Quadruped Robot

More information

Control of Snake Like Robot for Locomotion and Manipulation

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

More information

Experimental Verification of Stability Region of Balancing a Single-wheel Robot: an Inverted Stick Model Approach

Experimental Verification of Stability Region of Balancing a Single-wheel Robot: an Inverted Stick Model Approach IECON-Yokohama November 9-, Experimental Verification of Stability Region of Balancing a Single-wheel Robot: an Inverted Stick Model Approach S. D. Lee Department of Mechatronics Engineering Chungnam National

More information

Development of Vision System on Humanoid Robot HRP-2

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

More information

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

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

More information

PLANNING MOTIONS OF ROBOTIC SYSTEMS SUBJECT TO FORCE AND FRICTION CONSTRAINTS WITH AN APPLICATION TO A ROBOTIC CLIMBER

PLANNING MOTIONS OF ROBOTIC SYSTEMS SUBJECT TO FORCE AND FRICTION CONSTRAINTS WITH AN APPLICATION TO A ROBOTIC CLIMBER PLANNING MOTIONS OF ROBOTIC SYSTEMS SUBJECT TO FORCE AND FRICTION CONSTRAINTS WITH AN APPLICATION TO A ROBOTIC CLIMBER Akhil Madhani, Steven Dubowsky Department of Mechanical Engineering Massachusetts

More information

Simulation based Design for Robotic Care Device: Optimizing Trajectory of Transfer Support Robot

Simulation based Design for Robotic Care Device: Optimizing Trajectory of Transfer Support Robot Simulation based Design for Robotic Care Device: Optimizing Trajectory of Transfer Support Robot Yumeko Imamura, Ko Ayusawa, Yui Endo and Eiichi Yoshida Abstract This paper presents a framework of simulation

More information

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

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

More information

Cecilia Laschi The BioRobotics Institute Scuola Superiore Sant Anna, Pisa

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

More information

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

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

More information

QUANSER Flight Control Systems Design. 2DOF Helicopter 3DOF Helicopter 3DOF Hover 3DOF Gyroscope. Quanser Education Solutions Powered by

QUANSER Flight Control Systems Design. 2DOF Helicopter 3DOF Helicopter 3DOF Hover 3DOF Gyroscope. Quanser Education Solutions Powered by QUANSER Flight Control Systems Design 2DOF Helicopter 3DOF Helicopter 3DOF Hover 3DOF Gyroscope Quanser Education Solutions Powered by 2 DOF Helicopter What does it represent? Classic helicopter with main

More information

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

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

More information

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

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

More information

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

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

More information

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

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

More information

Vertical ladder climbing by the HRP-2 humanoid robot

Vertical ladder climbing by the HRP-2 humanoid robot Vertical ladder climbing by the HRP-2 humanoid robot Joris Vaillant, Abderrahmane Kheddar, Hervé Audren, François Keith, Stanislas Brossette, Kenji Kaneko, Mitsuharu Morisawa, Eiichi Yoshida, Fumio Kanehiro

More information

Dynamically Stepping Over Obstacles by the Humanoid Robot HRP-2

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

More information

Biped Walking Control Based on Hybrid Position/Force Control

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

More information

Leg Motion Primitives for a Dancing Humanoid Robot

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

More information

Walking without thinking about it

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

More information

HUMANOID robots have recently attracted growing social

HUMANOID robots have recently attracted growing social IEEE TRANSACTIONS ON ROBOTICS 1 Motion Retargeting for Humanoid Robots Based on Simultaneous Morphing Parameter Identification and Motion Optimization Ko Ayusawa, Member, IEEE, and Eiichi Yoshida, Senior

More information

LOCOMOTION AND BALANCE CONTROL OF HUMANOID ROBOTS WITH DYNAMIC AND KINEMATIC CONSTRAINTS. Yu Zheng

LOCOMOTION AND BALANCE CONTROL OF HUMANOID ROBOTS WITH DYNAMIC AND KINEMATIC CONSTRAINTS. Yu Zheng LOCOMOTION AND BALANCE CONTROL OF HUMANOID ROBOTS WITH DYNAMIC AND KINEMATIC CONSTRAINTS Yu Zheng A dissertation submitted to the faculty of the University of North Carolina at Chapel Hill in partial fulfillment

More information

Assist System for Carrying a Long Object with a Human - Analysis of a Human Cooperative Behavior in the Vertical Direction -

Assist System for Carrying a Long Object with a Human - Analysis of a Human Cooperative Behavior in the Vertical Direction - Assist System for Carrying a Long with a Human - Analysis of a Human Cooperative Behavior in the Vertical Direction - Yasuo HAYASHIBARA Department of Control and System Engineering Toin University of Yokohama

More information

Instant Prediction for Reactive Motions with Planning

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

More information

Inverse Kinematics for Humanoid Robots using Artificial Neural Networks

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

More information

Motion Capture & Simulation

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

More information

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

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

More information

Cerebellar Augmented Joint Control for a Humanoid Robot

Cerebellar Augmented Joint Control for a Humanoid Robot Cerebellar Augmented Joint Control for a Humanoid Robot Damien Kee and Gordon Wyeth School of Information Technology and Electrical Engineering University of Queensland, Australia Abstract. The joints

More information

Non-Gaited Humanoid Locomotion Planning

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

More information

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

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

More information

Learning Footstep Prediction from Motion. capture

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

More information

Robotics kinematics and Dynamics

Robotics kinematics and Dynamics Robotics kinematics and Dynamics C. Sivakumar Assistant Professor Department of Mechanical Engineering BSA Crescent Institute of Science and Technology 1 Robot kinematics KINEMATICS the analytical study

More information

navigation Isaac Skog

navigation Isaac Skog Foot-mounted zerovelocity aided inertial navigation Isaac Skog skog@kth.se Course Outline 1. Foot-mounted inertial navigation a. Basic idea b. Pros and cons 2. Inertial navigation a. The inertial sensors

More information

Torque-Position Transformer for Task Control of Position Controlled Robots

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

More information

Aerial Manipulator for Structure Inspection by Contact from the Underside

Aerial Manipulator for Structure Inspection by Contact from the Underside 2015 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS) Congress Center Hamburg Sept 28 - Oct 2, 2015. Hamburg, Germany Aerial Manipulator for Structure Inspection by Contact from

More information

Interaction Mesh Based Motion Adaptation for Biped Humanoid Robots

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

More information

MTRX4700 Experimental Robotics

MTRX4700 Experimental Robotics MTRX 4700 : Experimental Robotics Lecture 2 Stefan B. Williams Slide 1 Course Outline Week Date Content Labs Due Dates 1 5 Mar Introduction, history & philosophy of robotics 2 12 Mar Robot kinematics &

More information

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

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

More information

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

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

More information

Maintaining static stability and continuous motion in rough terrain hexapod locomotion without terrain mapping*

Maintaining static stability and continuous motion in rough terrain hexapod locomotion without terrain mapping* 24th Mediterranean Conference on Control and Automation (MED) June 21-24, 2016, Athens, Greece Maintaining static stability and continuous motion in rough terrain hexapod locomotion without terrain mapping*

More information

Motion Planning for Humanoid Robots: Highlights with HRP-2

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

More information

Design of a Three-Axis Rotary Platform

Design of a Three-Axis Rotary Platform Design of a Three-Axis Rotary Platform William Mendez, Yuniesky Rodriguez, Lee Brady, Sabri Tosunoglu Mechanics and Materials Engineering, Florida International University 10555 W Flagler Street, Miami,

More information

Dynamics modeling of structure-varying kinematic chains for free-flying robots

Dynamics modeling of structure-varying kinematic chains for free-flying robots Dynamics modeling of structure-varying kinematic chains for free-flying robots Roberto Lampariello, Satoko Abiko, Gerd Hirzinger Institute of Robotics and Mechatronics German Aerospace Center (DLR) 8 Weßling,

More information

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

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

More information

Humanoid Robotics Modeling by Dynamic Fuzzy Neural Network

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

More information

An Interactive Software Environment for Gait Generation and Control Design of Sony Legged Robots

An Interactive Software Environment for Gait Generation and Control Design of Sony Legged Robots An Interactive Software Environment for Gait Generation and Control Design of Sony Legged Robots Dragos Golubovic and Huosheng Hu Department of Computer Science, University of Essex, Colchester CO4 3SQ,

More information

Modeling Physically Simulated Characters with Motion Networks

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

More information

arxiv: v1 [cs.ro] 23 May 2018

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

More information

Hand. Desk 4. Panda research 5. Franka Control Interface (FCI) Robot Model Library. ROS support. 1 technical data is subject to change

Hand. Desk 4. Panda research 5. Franka Control Interface (FCI) Robot Model Library. ROS support. 1 technical data is subject to change TECHNICAL DATA 1, 2 Arm degrees of freedom 7 DOF payload 3 kg sensitivity joint torque sensors in all 7 axes maximum reach 855 mm joint position limits A1: -170/170, A2: -105/105, [ ] A3: -170/170, A4:

More information

Kinematics and dynamics analysis of micro-robot for surgical applications

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

More information

Optimization of a two-link Robotic Manipulator

Optimization of a two-link Robotic Manipulator Optimization of a two-link Robotic Manipulator Zachary Renwick, Yalım Yıldırım April 22, 2016 Abstract Although robots are used in many processes in research and industry, they are generally not customized

More information

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

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

More information

INSTITUTE OF AERONAUTICAL ENGINEERING

INSTITUTE OF AERONAUTICAL ENGINEERING Name Code Class Branch Page 1 INSTITUTE OF AERONAUTICAL ENGINEERING : ROBOTICS (Autonomous) Dundigal, Hyderabad - 500 0 MECHANICAL ENGINEERING TUTORIAL QUESTION BANK : A7055 : IV B. Tech I Semester : MECHANICAL

More information

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

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

More information

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

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

More information