Exploiting the Redundancy for Humanoid Robots to Dynamically Step Over a Large Obstacle Chengxu Zhou, Xin Wang, Zhibin Li, Nikos Tsagarakis, and Darwin Caldwell

Abstract—In this paper, we resolve the issue of stepping over a large obstacle by exploiting the redundancy of pelvis rotation and the versatility of foot trajectories for the humanoids. The control framework consists of a motion pattern that exploits the redundancy of pelvis rotation to enlarge the kinematic workspace, a generic foot trajectory generation which can be modified by a parametric interface to adapt to a specific task as well as utilizing the hip abduction to avoid obstacle collision. Moreover, the compensation strategies are also presented for reducing the discrepancies to implement the dynamic stepping motion on a real robot. The effectiveness is validated by COMAN’s capability of dynamically stepping over a large obstacle in both simulation and experiment.

Fig. 1.

The COMAN robot stepping over a large obstacle.

I. I NTRODUCTION The essential advantage and strength of the legged robots are the potential capability of negotiating rugged and unstructured terrains in contrast to the wheeled robots. However, this performance has not been widely demonstrated by real legged platforms, especially the humanoid robots. Without this critical capability, i.e. on the paved roads, legged robots would not attract potential applications compared with the wheeled machines. Though there are many humanoid robots that cope with different types of terrains such as rough or inclined [1]–[3] surfaces, the conventional decision of encountering an obstacle was to re-plan the path in order to avoid it [4]–[6], despite the robot might have the ability to step over it. The critical merit of humanoid robots was thus not exploited. Therefore, it is significant to manifest humanoid robots’ superior mobility in overcoming uneven terrain even with large obstacles. Very limited research on this topic has gained enough attentions in literature. ASIMO [7] could autonomous decide whether to step over an obstacle or re-planning the path using vision guided planner, however, the capability of traversing a large obstacle was not presented. In HRP-2 platform, Guan et al. [8] focused on stepping over obstacles in a quasi-static manner by keeping the Center of Mass’s (COM) projection on ground within the convex hull of support area. Also, Stasse et al. [9] used zero moment point (ZMP) criterion to maintain the dynamic stability, and demonstrated that the HRP-2 robot could dynamically cross over an obstacle of 15cm as high as 21% of the its leg length, and improved the duration of stepping over from 40s to 4s compared to the quasi-static case. This work is supported by the FP7 European project WALK-MAN (ICT2013-10). Authors are with the Department of Advanced Robotics, Istituto Italiano di Tecnologia, via Morego 30, 16163 Genova, Italy. Email: [email protected]

The static and quasi-static stepping over strategies have several limitations as follows: 1) requiring powerful and stiff motors for keeping the static or quasi-static stability; 2) requiring much more time to accomplish one task; 3) requiring more control effort to implement on an intrinsically compliant humanoid robot. Particularly, the DARPA Robotics Challenge (DRC) requires the humanoid robots to have the potential to be deployed during a disaster response. The one of the greatest hurdle is their locomotion capability, which is still poorer than humans. It is strongly demanded that humanoid robots should be capable of autonomously overcoming obstacles, which means that robots can detect the environment and determine the feasibility of stepping over the obstacle, then make a decision for their next movement. This is especially important, since in the disaster site, it is very much unlikely to have a clean path without any obstacles. Several teams have been already advancing ahead in this field [10]–[12]. The dynamic stepping over strategies without the utilization of redundancy or the versatility of foot trajectories have several obvious limitations. It restricts the humanoids to perform a longer and higher step, or easily encounter kinematic singularity while trying to do so. Moreover, without exploiting the redundancy in the trajectory planning stage could spend unnecessary computational power for doing complex optimization for a high degree of freedom (DOF) humanoid. Therefore, to maximize the humanoid robot’s entire potential in mobility, we focus on the development of deterministic algorithms for exploiting the pelvis rotation and foot trajectories. We will demonstrate the feasibility to overcome large obstacles and achieve more human-like behavior as an alternative to the optimization approach which is more sophisticated and requires much higher computational power. The testbed on which we study is the COmpliant Hu-

Author’s preprint version for academic circulation only. Please find official paper from IEEE Xplore. MANoid COMAN (Fig. 1). It is a full body robot developed based on the compliant leg prototype in [13], [14] capable of stable dynamic walking [15]. The pitch joints of the lower body are selected to equip the passive elastic elements to retain the capability of instantaneous shock absorption, while at the same time to shift the system resonance out of the operation frequency. To enable COMAN to step over a large barrier, we apply deterministic algorithms to explore the pelvis rotational motion to enlarge the leg’s workspace in the direction of stepping, and to make good use of the diversity of all possible swing foot trajectories to negotiate with the obstacles without violating the kinematic constraints. The paper is organized as follows. Section II delineates the design of swing foot trajectory design, the exploitation of the redundancy of pelvis rotation, and the collision avoidance for stepping over a large obstacle. Section III introduces ankle backlash and the gravity compensation for the pelvis abduction, as well as the whole control framework for implementing the proposed theoretical algorithms on real robot. Section IV and Section V successfully demonstrate the effectiveness in simulation and experiments respectively. We summarize and conclude our study in Section VI.

foot-ground clearance and more perpendicular touchdown angles with respect to the ground surface could reduce undesired sliding at lifting and landing. The foot trajectory pattern defines the relationship between percentage of the step length and the percentage of the lift height, ftemp : pSL →pLH . Thus, we can generate the foot trajectory by scaling and tuning the pattern using the target parameters to accommodate different tasks: " # " pSL x y = 0 z 0

0 pSL 0

0 0 pSL + ftemp (pSL )

#"

xtarg ytarg ztarg + hLH

#

(4)

where xtarg , ytarg , ztarg are the target positions of the swing foot, and hLH represents the maximum lift height during the swing phase. The red line in Fig. 2 shows an example of the swing foot trajectory. The used parameters are: 22.5cm forward step length, 5cm side step width, 5cm of lift up height on a stair, and 4cm foot clearance.

II. E XPLOITING R EDUNDANCY OF P ELVIS ROTATION AND V ERSATILITY OF S WING F OOT T RAJECTORY D ESIGN A. Generic Foot Trajectory Design The swing foot trajectory is generated based on a nondimension pattern as shown in Fig. 2 by the blue line. The pattern is a cubic spline curve with natural boundary conditions in the Cartesian space. Given a set of interpolation points {(x0 , z0 ),· · · , (xn , zn )} with x0 < x1 < · · · < xn to constrain the profile of the trajectory. Define the piecewise cubic polynomials fi : [xi , xi+1 ]→R by fi (x) =ai (x − xi )3 + bi (x − xi )2 + ci (x − xi ) + zi ,

x ∈ [xi , xi+1 ]

Fig. 2.

Swing foot trajectory and template.

(1)

for the overall function to be twice continuously differentiable, it is required that   fi (xi+1 ) = fi+1 (xi+1 ) = zi+1 0 f 0 (xi+1 ) = fi+1 (xi+1 ) (2)  i00 00 fi (xi+1 ) = fi+1 (xi+1 ) at the intermediate points. Particularly, to further gain a better clearance and smoothness at lifting and landing, we set the second order derivative to zero at both boundaries. Following the boundary constraints,  f0 (x0 ) = z0    00 f0 (x0 ) = 0 , (3) f = zn  n (xn )   00 fn (xn ) = 0

Fig. 3.

The variation of the height and the vertical velocity.

In order to use the trajectory to control the robot, we need to add the time mapping pSL = τ (t) to transform these formulations from three dimensional space R3 to four dimensional space [R3 , t]. To avoid high impact shock at landing and to smooth the motion pattern transition at lifting, we use the third order polynomial interpolation to formulate

by combining the continuous conditions in (2), we could obtain the trajectory pattern with sufficient lift up and touchdown angles by tuning the set of interpolation points. The sufficient 2

Author’s preprint version for academic circulation only. Please find official paper from IEEE Xplore.

the time mapping τ (t), τ (t) = at3 + bt2 + ct + d,

t ∈ [0, 1]

(5)

where t is the percentage of the step time, and τ (0) = 0, τ 0 (0) = 0, τ 00 (0) = 0, τ (1) = 0, τ 0 (1) = 0, τ 00 (1) = 0. As shown in Fig. 3, the variation of the position and velocity on the vertical direction are all continuous, and velocity is zero at both the landing and lifting phases. B. Exploiting Redundancy of Pelvis Rotation Stepping over a large obstacle challenges the kinematic limitation of a humanoid robot that the kinematics singularity could easily occur. Therefore, it is essential to control the robot to the near singularity condition. Here, taking advantage of the redundancy of the pelvis rotation, the singularity dilemma can be prevented. As shown in Fig. 4, by rotating the pelvis during the walking, it is not necessary to extend the leg as much as the case of the original pelvis orientation to perform the same step length. Therefore, the knee singularity can be avoided.

Fig. 5.

Abduction of the leg to avoid the collision.

Step Length Leg Length Before Turning Ψ𝑝𝑒𝑙𝑣𝑖𝑠

y

z

x

Fig. 4.

Leg Length After Turning

Top view of pelvis rotation.

Fig. 6. The comparison of the trajectory with and without abduction strategy.

Based on the geometric correlation between the pelvis yaw rotation and the alternation of support legs, the cooperative yaw rotation Ψpelvis can be generated in a straightforward manner as Ψpelvis = k(xrf t − xlf t ), (6)

Apart from the trajectory design in the Cartesian space, the physical joint limitations can also cause problems in the joint space. As shown in Fig. 5, the foot of the dashed leg cannot maintain its desired orientation, and clashes on the obstacle. Especially the ankle pitch joint limit causes the tilting limitation of the foot, and makes the toe stumble into the obstacle, as shown in Fig. 6 by red line. In this situation, we need to check the whole edges of the swing foot. The collision detection can be performed through geometric computation based on the regular obstacle shape in the plane of travel, in our case, the sagittal plane. Given two vectors −−−−→ −−−−−→ Pi Pi+1 , Oj Oj+1 , where i, j = 1, 2, 3, 4, are the perpendicular vectors on sagittal plane of the edges of the foot and the obstacle, as shown in Fig. 6. They are intersected if and only −−−→−−−−−→ ≤ 0 [8]. A−−−−→−−−−−→ if the collision index A− Pi Pi+1 Oj Oj+1 Pi Pi+1 Oj Oj+1 is the production of two areas of the triangle formed by points sets {Pi , Qj , Qj+1 } and {Pi+1 , Qj , Qj+1 }. The collision index can be calculated as 1 −−−→ −−−−−→ −−−→−−−−−→ = kOj Pi × Oj Oj+1 k2 A− Pi Pi+1 Oj Oj+1 2 (7) 1 −−−−→ −−−−−→ · kOj Pi+1 × Oj Oj+1 k2 2

where k is the ratio factor between the desired rotational angle and the step length, xlf t and xrf t are the position of left and right foot along walking direction, respectively. The feet trajectories generated in Section II-A are second derivative continuous with the boundary conditions of zero velocity and acceleration. Therefore, the continuous conditions of Ψpelvis is guaranteed. C. Collision Check For stepping over an obstacle, we should check the position of the edge of the foot to make sure that it would not collide with the obstacle. Thus, we set a safety margin around the obstacle, as shown in Fig. 6 by the red shadow area. Besides the trajectory generation, we also compared the trajectory of the foot with the obstacle region. If any section of the trajectory is inside the obstacle region, then hLH needs to be increased until no trajactory passes through the obstacle region. 3

Author’s preprint version for academic circulation only. Please find official paper from IEEE Xplore.

Based on the collision check of the four corners of the foot, P1 , P2 , P3 , P4 , we can further explore the abduction DoF of the leg, φabd , as shown in Fig. 5. Then, three hip joints are synchronized to generate the abduction movement. The angles of three hip joints can be calculated through virtual leg rotation: −1

Rcomp = Rz (Ψpelvis )

Rx (Φabd )Rz (Ψpelvis )

Therefore, it is important to compensate for the ankle backlash to eliminate this unexpected disturbance. A nonlinear compensation is introduced as shown in Fig. 7, the ankle compensation angle θankle is defined as a function of COP measurement in the support foot,  xcop ≥ xupper  θankle = α, θankle = 0, xcop ≤ xlower (12)  θankle = θankle , xlower < xcop < xupper

(8)

where Rcomp is the rotation matrix cause of the hip compensation, Rx (Φabd ) represents the abduction movement along heading direction, Rz (Ψpelvis ) is the pelvis rotation. Fig. 6 shows that, with exploitation of the abduction redundancy strategy (blue line), the robot could step over the obstacle. At last, by combining with the kinematics limitation, the constraint used for the trajectory generation should be as follows,  (9)   qimin ≤ qi (t) ≤ qimax , i = 1, 2,· · · , 15 −−−→−−−−−→ > 0, A− ∀i, j ∈ {1, 2, 3, 4} (10) Pi Pi+1 Oj Oj+1   ylf t ≥ yrf t . (11)

where α is the backlash angle measured beforehand, xupper and xlower are the upper and lower COP limits to add or deduct the ankle compensation. θankle will then pass through a low-pass filter to guarantee the continuity. B. Feed-forward Gravity Compensation

where (9) is the constraint on the joint limits (6 DoF for each leg and 3 DoF for torso), (10) represents the constraints to avoid collision with an obstacle, and (11) states that the position of the left foot (ylf t ) would not cross over right foot on the lateral direction to avoid the self-collision of the leg. These constraint formulas will be used as one module in the robot control.

θ𝑔𝑟𝑎𝑣𝑖𝑡𝑦

Fig. 8.

III. C OMPENSATION S CHEME FOR THE R EALIZATION O N THE R EAL H UMANOID

Due to the limited stiffness, the torque generated by the weight of the upper body and swing leg will cause a deflection in the support leg’s hip joints, which will tilt the upper body then result in an early landing problem of the swing leg. The robot will gradually lose its balance influenced by the early landing impacts. Therefore, a feed-forward gravity compensation strategy is introduced. As shown in Fig. 8, since the generated walking trajectories are known, the compensation angle θgravity can be calculated accordingly using a simplified model which only has three point masses located at upper body, left and right leg’s COM respectively. The stiffness of hip joints is identified experimentally in advance.

As a humanoid robot with compliant joints, the COMAN robot needs more control efforts to realize the stable and dynamic movements than its rigid peers. Therefore, a special effort needs to be made on the compensation scheme to bridge the gap between the ideal model and the real robot. It is crucial for the implementation of theoretical control algorithms to be successful on the real robot. A. Backlash Compensation Compensation Angle

C. Control Framework

Foot Length 𝛼

Fig. 9 shows the control framework for dynamically stepping over obstacles. The white blocks are the general modules for dynamic walking used in COMAN, due to its generic property, combining additional sub-modules such as stepping over or omnidirectional walking does not require further modification of these basic modules. The blue blocks are the strategies proposed for stepping over previously described in this paper. The pattern generator used in this work is firstly introduced by Kajita et al. [16] which uses the preview controller to maintain dynamic stability based on the ZMP criterion. The COM reference, pelvis orientation after pelvis rotation strategy and feet trajectories generated by the generic pattern after the

𝜃𝑎𝑛𝑘𝑙𝑒

𝑥𝑙𝑜𝑤𝑒𝑟 Fig. 7.

0

𝑥𝑢𝑝𝑝𝑒𝑟

Gravity Compensation.

Single Foot COP

Backlash Compensation.

A humanoid robot can be seen as an inverted pendulum with pivot at its support foot during walking. Hence, even a tiny backlash in the ankle joint generates significant displacement at the COM level, which will deteriorate the state of robot. 4

Author’s preprint version for academic circulation only. Please find official paper from IEEE Xplore.

Fig. 10.

Fig. 9.

Feet trajectories of the stepping over obstacle in simulation.

Control framework of proposed stepping over strategies.

obstacle collision check, are the inputs to the COM based inverse kinematics [17]. Then the desired joint angles combined with support foot ankle backlash and hip feed-forward gravity compensations will be passed to a joint limitation validation in order to keep robot within the joints’ workspace. During the whole motion, a local stabilizer [18] is enabled for COMAN to cope with unexpected impacts and disturbances. IV. S IMULATION In this Section, the proposed control framework is implemented on a multi-body humanoid robot simulated in the Open Dynamic Engine (ODE). This model has the same physical parameters of COMAN [14]. It has 6 DOFs in each leg, 3 DOFs in the waist, only these 15 DOFs are controlled during the following tests. The upper body joints are controlled to hold the initial position. The obstacle is modeled as a block with dimensions of 10cm high by 5cm wide. Considering the foot size (14×9cm) of COMAN and its kinematic limits, as well as the 1cm safe margin around the obstacle, the step length to walk over the obstacle is designed as 24cm with the lift height of 12cm, which are 47.4% and 23.7% of the leg length respectively. The pelvis rotation angle ratio k in (6) is set to be 0.01◦ /m. This means that an incremental change of 1cm distance between two feet along walking direction corresponds to the change of 1◦ at the pelvis yaw rotation. Therefore, Ψpelvis will reach its maximum of 24◦ during the double support phase while the robot is passing over the obstacle. The abudction angle Φabd is designed with half sinusoidal shape with the maximum amplitude of 15◦ and applied during the swing phase. The feet trajectories are shown in Fig. 10, the red line represents the left foot which steps over the obstacle first, and then the right foot in blue follows whose orientation is changed during swing phase due to the hip compensation using (8). As shown in Fig. 11, the pelvis rotation angle changes according to the feet distance within one step cycle, which

Fig. 11. Pelvis rotation and hip compensation refer to right leg in simulation.

modulates from 0◦ to −24◦ during right foot support phase, keeps the maximum rotation angle throughout double support, then reduce back to 0◦ during the swing phase of the right leg. Fig. 11 also shows the right hip joints’ difference with and without the exploitation of the hip abduction movement. It can be seen that the orientation modification Rcomp is realized by both the roll and pitch joints of the right hip. V. E XPERIMENTS The same setting of parameters in Section IV are applied to the real robot in order to experimentally validate the proposed control framework. The gait is generated by the pattern generator: the step time is 1.5s and the double support phase is 20% of the step time. The backlash α in (12) is measured as 2.0◦ , and the xupper and xlower are 0.01m and 0m, respectively. The maximum feed-forward gravity compensation reaches 10◦ and 9◦ of left and right hip roll joint during single support phase, respectively. Unlike the ideal simulation, without these necessary compensations, though COMAN is capable of walking with small steps, it loses balance immediately while trying a longer step 5

Author’s preprint version for academic circulation only. Please find official paper from IEEE Xplore.

0.0s

0.5s

1.0s

1.5s

2.0s

2.5s

3.0s

2.0s

2.5s

3.0s

(a) Perspective

0.0s

0.5s

1.0s

1.5s (b) Front view

Fig. 12.

Snapshots of successful stepping over a large obstacle.

or stepping over the obstacle. Thanks to the compensation scheme, COMAN is capable of stepping over an obstacle of 10×5cm which is almost 20% of its leg length. Fig. 12 shows both the perspective and the front view of COMAN during the same experiment of stepping over this large obstacle.

proposed strategies can be used to generate dynamically stable stepping motion. R EFERENCES [1] K. Hashimoto, Y. Sugahara, H. Sunazuka, C. Tanaka, A. Ohta, M. Kawase, H. Lim, and A. Takanishi, “Biped landing pattern modification method with nonlinear compliance control,” in IEEE International Conference on Robotics and Automation, may 2006, pp. 1213 –1218. [2] T. Takubo, Y. Imada, K. Ohara, Y. Mae, and T. Arai, “Rough terrain walking for bipedal robot by using zmp criteria map,” in IEEE International Conference on Robotics and Automation., May 2009, pp. 788–793. [3] J. Kim, I. Park, and J. Oh, “Walking control algorithm of biped humanoid robot on uneven and inclined floor,” Journal of Intelligent & Robotic Systems, vol. 48, no. 4, pp. 457–484, 2007. [4] J. Chestnutt, M. Lau, G. Cheung, J. Kuffner, J. Hodgins, and T. Kanade, “Footstep planning for the honda asimo humanoid,” in IEEE International Conference on Robotics and Automation, April 2005, pp. 629– 634. [5] K. Sabe, M. Fukuchi, J.-S. Gutmann, T. Ohashi, K. Kawamoto, and T. Yoshigahara, “Obstacle avoidance and path planning for humanoid robots using stereo vision,” in IEEE International Conference on Robotics and Automation, vol. 1, April 2004, pp. 592–597 Vol.1. [6] R. Deits and R. Tedrake, “Footstep planning on uneven terrain with mixed-integer convex optimization,” in IEEE-RAS International Conference on Humanoid Robots., Nov 2014, pp. 279–286. [7] P. Michel, J. Chestnutt, J. Kuffner, and T. Kanade, “Vision-guided humanoid footstep planning for dynamic environments,” in IEEE-RAS International Conference on Humanoid Robots, December 2005, pp. 13– 18. [8] Y. Guan, E. Neo, K. Yokoi, and K. Tanie, “Stepping over obstacles with humanoid robots,” IEEE Transactions on Robotics, vol. 22, no. 5, pp. 958– 973, October 2006. [9] O. Stasse, B. Verrelst, B. Vanderborght, and K. Yokoi, “Strategies for humanoid robots to dynamically walk over large obstacles,” IEEE Transactions on Robotics, vol. 99, pp. 1–8, 2009. [10] M. Morisawa, N. Kita, S. Nakaoka, K. Kaneko, S. Kajita, and F. Kanehiro, “Biped locomotion control for uneven terrain with narrow support region,” in IEEE/SICE International Symposium on System Integration (SII), Dec 2014, pp. 34–39.

VI. C ONCLUSION This paper presents a control framework for a humanoid robot to step over a large obstacle. It proves that it is unnecessary neither shortening the double support phase nor lowering the COM height for the purpose of stepping over. By only combining the stepping over module to the generic dynamic walking framework, the robot could accomplish the mission without any modification of the normal walking gait pattern. The proposed strategies include a generic foot trajectory module which can be modified to a specific task, and the redundancy of pelvis rotation is used during walking in order to avoid reaching robot’s kinematic limits, as well as the validation of the margin between the foot and obstacle then adding the hip abduction to avoid collision. Additionally, ankle backlash and hip joint compensations are introduced in experiment. Both results in simulation and experiment show the strategies could successfully accomplish the challenging task of stepping over a obstacle of the height of almost 20% of the leg length. Future work will focus on the autonomous stepping over obstacles by using the vision perception, involving recognition of the obstacle’s geometrical volume and location. The information from perception will be firstly used to check the stepping over feasibility and collision avoidance, thus the 6

Author’s preprint version for academic circulation only. Please find official paper from IEEE Xplore.

[11] S. Kuindersma, F. Permenter, and R. Tedrake, “An efficiently solvable quadratic program for stabilizing dynamic locomotion,” in IEEE International Conference on Robotics and Automation, May 2014, pp. 2589– 2594. [12] S. Feng, E. Whitman, X. Xinjilefu, and C. G. Atkeson, “Optimizationbased full body control for the darpa robotics challenge,” Journal of Field Robotics, vol. 32, no. 2, pp. 293–312, 2015. [13] N. Tsagarakis, Z. Li, J. A. Saglia, and D. G. Caldwell, “The design of the lower body of the compliant humanoid robot ‘cCub’,” in IEEE International Conference on Robotics and Automation, Shanghai, China, 2011, pp. 2035–2040. [14] N. Tsagarakis, S. Morfey, G. Medrano-Cerda, Z. Li, and D. Caldwell, “Compliant humanoid coman: Optimal joint stiffness tuning for modal frequency control,” in IEEE International Conference on Robotics and Automation (ICRA), 2013, pp. 665–670. [15] Z. Li, N. G. Tsagarakis, and D. G. Caldwell, “Walking pattern generation for a humanoid robot with compliant joints,” Autonomous Robots, 2013, conditionally accepted. [16] S. Kajita, F. Kanehiro, K. Kaneko, K. Fujiwara, K. Harada, K. Yokoi, and H. Hirukawa, “Biped walking pattern generation by using preview control of zero-moment point,” IEEE International Conference on Robotics and Automation, pp. 1620–1626, 2003. [17] Z. Li, N. Tsagarakis, and D. Caldwell, “A passivity based admittance control for stabilizing the compliant humanoid COMAN,” in IEEE-RAS International Conference on Humanoid Robots, Osaka, Japan, Nov. 29th - Dec. 1st 2012, pp. 44–49. [18] C. Zhou, Z. Li, J. Castano, H. Dallali, N. G. Tsagarakis, and D. G. Caldwell, “A passivity based compliance stabilizer for humanoid robots,” in IEEE International Conference on Robotics and Automation, Hong Kong, China, May 31 - June 7 2014, pp. 1487–1492.

7

Exploiting the Redundancy for Humanoid Robots to ...

legged platforms, especially the humanoid robots. Without this ... In HRP-2 platform, Guan et al. ..... Conference on Robotics and Automation, may 2006, pp.

3MB Sizes 6 Downloads 214 Views

Recommend Documents

Humanoid-Robots-New-Developments.pdf
Connect more apps... Try one of the apps below to open or edit this item. Humanoid-Robots-New-Developments.pdf. Humanoid-Robots-New-Developments.pdf.

Walking Trajectory Generation for Humanoid Robots ...
experimental research platform, Fig. 1. The conventional bipedal ..... IEEE International Conference on Robotics and Automation, pp. 76–. 81, 2006. [5] N.G. ...

Planning support contact-points for humanoid robots ...
Email: [email protected] ... Email: [email protected] ..... [5] J. Xiao and X. Ji, “A divide-and-merge approach to automatic generation of contact ...

Redundancy, Redundancy, Redundancy: The Three ...
Mar 31, 2010 - visual understanding step, a central component of intelli- gence, achieves ..... cording to correspondence points, which we call anatomical landmarks, or .... For the former task, we used an in-house database of close to 1500 ...

Redundancy, Redundancy, Redundancy: The Three ...
Mar 31, 2010 - Automatic detection and tagging of anatomical structures, ...... (e) shows a case of strong patient motion, and the algorithm handled it robustly.

Stabilization Control for Humanoid Robot to Walk on ...
To control robot's posture, torque and tilted angular velocity are modeled as the parameters of a network system. Fig. 3(a) and Fig. 3(b) show the inverted pendulum model of robot and its corresponding one-port network system, respectively. The robot

exploiting the tiger - Anachak
The Temple does not have such a licence but has, by its own records, bred at least 10 ... To be part of a conservation breeding programme, the genetic make-up and history of ..... Of the 11 tigers listed on the Temple's website in 2008, two have.

exploiting the tiger - Anachak
shown around the world on the Discovery Network), tourist numbers grew ... A mother and her young are the basic social unit occupying a territory. Males are .... All adult tigers are kept in separate pens, apart from the time each day when they.

Content Aware Redundancy Elimination for Challenged Networks
Oct 29, 2012 - Motivated by advances in computer vision algorithms, we propose to .... We show that our system enables three existing. DTN protocols to ...

Quasi-Straightened Knee Walking for the Humanoid Robot
IEEE Transactions on Robotics and Automation 17(3), 280–289. (2001). 4. Kajita, S. ... manoid platform for cognitive and neuroscience research. Advanced ...

A Practical Improvement to the Partial Redundancy ...
program along path P, if P is a path leading to the point q and the expression occurs at some point r on P with no changes to its operands between r and q on P.

Exploiting Similarities among Languages for Machine Translation
Sep 17, 2013 - translations given GT as the training data for learn- ing the Translation Matrix. The subsequent 1K words in the source language and their ...

Exploiting the P300 paradigm for cognitive biometrics ...
School of Computer Science and Electronic Engineering,. University of Essex ... Raveendran Paramesran received the BSc and MSc degrees in Electrical .... Figure 2 Spatially varying oddball paradigm (see online version for colours). Stage. 1.

Exploiting the Power of Relational Databases for ...
Mar 26, 2009 - last years that lead to the development of specialized stream ... tions, financial, web applications, etc. .... functionality of advanced DBMSs.

Evolution in Materio: Exploiting the Physics of Materials for ... - arXiv
Nov 17, 2006 - computer, and the set of differential equations and boundary conditions that ... Of course we cannot directly program the molecular dy- namics and we do not have ... tionary programming in an FPGA was described by [10] and [11]. ... be

Exploiting Graphics Processing Units for ... - Springer Link
Then we call the CUDA function. cudaMemcpy to ..... Processing Studies (AFIPS) Conference 30, 483–485. ... download.nvidia.com/compute/cuda/1 1/Website/.

Exploiting desktop supercomputing for three ...
Oct 8, 2008 - resolution, the size and number of images involved in a three-dimensional reconstruction ... High resolution structural studies demand huge computational ... under the conditions that the image data, as well as the informa-.

Exploiting desktop supercomputing for three ...
Oct 8, 2008 - under the conditions that the image data, as well as the informa- ...... Also, memory and hard disk storage prices drop, leading to more powerful ...

Exploiting Treebanking Decisions for Parse Disambiguation
new potential research direction by developing a novel approach for extracting dis- .... 7.1 Accuracies obtained on in-domain data using n-grams (n=4), local.

Exploiting Treebanking Decisions for Parse Disambiguation
3See http://wiki.delph-in.net/moin/LkbTop for details about LKB. 4Parser .... is a grammar and lexicon development environment for use with unification-based.

Free PDF Exploiting The Digital Oilfield: 15 Requirements for Business ...
Nov 20, 2012 - REQUIREMENTS FOR BUSINESS VALUE BY DUTCH HOLLAND PDF ... The link that we provide in this site is available to click and afterwards .... resource required to enable work processes and enterprise optimization.

Exploiting Similarities among Languages for Machine Translation
Sep 17, 2013 - ... world (such as. 1The code for training these models is available at .... CBOW is usually faster and for that reason, we used it in the following ...