Robot motion planning for the humanoid robot HOAP-3

Size: px
Start display at page:

Download "Robot motion planning for the humanoid robot HOAP-3"

Transcription

1 Robot motion planning for the humanoid robot HOAP-3 Xochitl Hernandez V., Abraham Sánchez L. and Pablo Camarillo R. Computer Science Department Benemérita Universidad Autónoma de Puebla Puebla, Pue. - México hevexo3@hotmail.com, asanchez@cs.buap.mx, p.camarillor@gmail.com Abstract In the field of robotics there is a great interest in developing strategies and algorithms to reproduce humanlike behavior. Programming a humanoid robot to walk is a challenging problem. Traditional approaches rely heavily on prior knowledge of the robot s physical parameters to devise sophisticated control algorithms for generating a stable gait. We present two approaches to solve the motion planning problem for humanoid robots, one of them is based on a classic robot motion planning idea and the other is a novel idea based on the learning human behavior by imitation. practice and converge towards a uniform exploration of the search space. In the second proposed approach, we showed as a humanoid robot can learn to walk directly by imitating a human gait obtained from motion capture. The training using human motion capture is an intuitive and flexible approach to program a robot, but the direct use of the data results in dynamically unstable motions. We propose an approach to tractable imitation-based learning in humanoids. I. INTRODUCTION Motion planning is one of the key capabilities for autonomous humanoid robots. Previous researches have focused on weight balancing, collision detection, and gait generation. The motion for a humanoid robot to achieve a given goal is typically very complex because of the degrees of freedom involved and the contact constraint that needs to be maintained. Due to the curse of dimensionality, developing practical motion planning algorithms for humanoid robots is a daunting task. Humanoid robots such as HOAP- 3 (Figure 1) have 28 or more degrees of freedom. The problem is further complicated by the fact that humanoid robots must be controlled very carefully in order to maintain overall static and dynamic stability. These constraints severely restrict the set of allowable configurations and prohibit the direct application of existing sampling-based motion planning techniques [3], [5]. Recently, these kind of algorithms that account for system dynamics have been developed for 2D and 3D rigid bodies with state spaces of up to twelve dimensions. These methods have yet to be applied to complex articulated models such as humanoid robots. It has been suggested to limit the active body degrees of freedom for humanoid robot motion planning and balance control, though these ideas are still under development [4], [1]. Our first approach is to adapt a variation of the randomized planner described in [5] to compute full-body motions for humanoid robots that are both dynamically-stable and collision-free. This planner and its variants utilize Rapidlyexploring Random Trees (RRTs) combined with a simple greedy heuristic that aggressively tries to connect two search trees, one from the initial configuration and the other from the goal. These methods have been shown to be efficient in Figure 1. The virtual and the real dynamic humanoid robot Hoap-3. The paper is organized as follows. Some important details of the humanoid robot Hoap-3 are presented in section II. Section III presents the motion planning problem oriented to humanoid robots, in this section we detail the two proposed approaches. Some simulation results are presented and discussed in Section IV, and finally Section V gives some concluding remarks and future works. II. HOAP-3 Robotics research activities have been very active in developing robots, particularly humanoid robots, which can coexist with human beings. Robots that can perform a variety of work in collaboration with human beings are expected to come into being in the near future. Fujitsu Laboratories Ltd. has successfully developed its Hoap-1, Hoap-2 and Hoap-3 miniature robots, which can be utilized in a variety of research and development applications such as development of bipedal walking motion control algorithms and working robot motion algorithms in combination with the basic simulation software, research on human-to-robot communication interfaces, etc. 60

2 HOAP-3, measuring 60 cm tall (23.6 inches) and weighing 8.8 kg (19 lbs), builds on HOAP-2 s ease of use and mobility by adding functions that improve its ability to interact with its environment. The HOAP-3 can be controlled with a personal computer (either wired or wireless) and uses a 1.1GHz Pentium M processor that runs on RT-Linux. This robot has a total of 28 joints in two arms of 6 flexibility, two legs of 6 flexibility, and the head of 3 flexibility and the body part of 1 flexibility, see Figure 2. It is rotation flexibility altogether and a leg, an arm, and the waist are serial links. Figure 2. Kinematics structure of Hoap-3 humanoid robot. The geometric model represents each part of HOAP-3 robot by a fixed mesh of few triangles, as depicted in Figure 1. These meshes are rigidly attached to coordinate frames hierarchically organized in a tree. The root of the tree is the coordinate frame attached to the hips, and represents the global translation and orientation of the model. Each subsequent node in the tree represents the three-dimensional rigid transformation between the node and its parent. This representation is normally called a skeleton or kinematic chain (Figure 2). Each node, together with its corresponding attached body part is called a bone. Each bone is allowed to rotate but not translate with respect to its parent around one or more axes. Thus, at a particular time instant t, the pose of the skeleton can be described by Φ(t) = (R (t), s (t), ϕ (t) ), where R (t) and s (t) are the global orientation and translation of the root node, and ϕ (t) is the set of relative rotations between successive children. For upper-body motion, it is assumed that only ϕ needs to be updated. III. MOTION PLANNING Motion planning is one of the fundamental problems in mobile robot navigation. It has been shown long before that the problem of moving an object through space is PSPACEhard with a time complexity exponential in the degrees of freedom of the object. In mobile robots the degrees of freedom are usually small (three or less) which opens the application of a range of search techniques specifically tailored to the problem. Humanoid robots while being mobile allow for more than the usual three degrees of freedom. Their feet can be placed with a greater choice and the change of body posture allows to overcome obstacles where wheeled robots fail in passing through. The higher degrees of freedom can be tackled, e.g. by sampling-based approaches such as probabilistic roadmaps [3] or RRTs [5]. However, if one can employ a non-probabilistic approach by finding a suitable approximation then the solution can be seen preferable due to its deterministic nature. One possible approximation is to model the robot as a cylinder or by its convex hull which allows for efficient collision checking. Humanoid robots are non-holonomic, i.e. they cannot turn in place without requiring additional space. The trajectory of the body center describes a curve similar to a car-like robot, although the turn radius is generally quite small. The environment in which the humanoid robot moves is W. R is a collection of p links L i (i = 1,..., p) organized in a kinematic hierarchy with Cartesian frames F i attached to each link. We denote the position of the center of mass c i of link L i relative to F i (see Figure 2). A configuration or pose of the robot R is denoted by the set P = {T 1, T 2,..., T p }, of p relative transformations for each of the links L i as defined by the frame F i relative to its parent link s frame. The base or root link transformation T 1 is defined relative to some world Cartesian frame F world. A configuration is denoted by q C (C, is the configuration space), a vector of n real numbers specifying values for each generalized coordinates of R. One can define the C-obstacle region CB C as the set of all configurations q C where one or more of the links of R intersect with another link of R. The open subset C\CB is denoted by C free, and it represents the space of collision free configurations in C of the robot R. Let FORWARD(q) be a forward kinematics function mapping values of q to a particular pose P. FORWARD(q) can be used to compute the global transformation G i of a given link frame F i relative to the world frame F world. Let X (q) be a vector relative to F world representing the global position of the center of mass of R while in the configuration q. A configuration q is statically stable if the projection of X (q) along the gravity vector g lies within the area of support SP (i.e., the convex hull of all points of contact between R and the support surface in W.) Let C stable C be the subset of statically stable configurations of R. Let 61

3 C valid = C stable C free denote the subset of configurations that are both collision free and statically stable postures of the robot R. C valid is called the set of valid configurations. Any statically-stable trajectory can be transformed into a dynamically-stable trajectory by arbitrarily slowing down the motion [2], [10] A zero moment point (ZMP) is a key concept of dynamic balance maintenance [11]. It is the point where the moment induced by the ground reaction becomes zero. When we consider static balance, the condition of equilibrium is that the projection of the center of mass (CM) is inside the supporting area by the feet. If it goes out of the area, the static balance is broken and the human begins to fall down. However, when we consider dynamic balance, the human does not lose his or her control unless the ZMP is inside the support area, even if the projection of the CM goes out to the area. If the ZMP is on the boundary of the area, the human begins to fall down. Contrary to the projection of the CM in static balance, the ZMP stays on the boundary during falling down and never gets out of the area (Figure 3). Figure 3. ZMP vs. projection of the CM. A. A classical robot motion planning approach Most real-world motion planning problems have dynamic, as well as static constraints. Early randomized motion planning algorithms did not take into account these dynamic constraints. These algorithms generated a solution path in the configuration space, and then determined control inputs to steer along the path. Kinodynamic motion planning eliminates this second step by incorporating dynamic constraints into the global planner, but in doing so, it doubles the dimensionality of the motion planning problem. RRRTs are a class of randomized algorithms that can be used both for systems involving kinodynamic constraints or not [6]. The RRT-Connect algorithm is a single-shot planning algorithm that attempts to find a path by connecting two growing RRT s rooted at the initial and goal configurations. The idea of the algorithm is illustrated in Figure 4. T a and T b denote two RRT s rooted at the initial configuration, q init and the goal configuration, q goal, respectively. The algorithm starts by letting T a explore outward with the Figure 4. The RRT-Connect algorithm. EXTEND operation. This operation first samples a point (q rand ) in the configuration space and then finds the nearest configuration (q near ) to this sampled point. We extend q near to a new configuration q new by some distance ε toward q rand. Then we try to connect a nearest node of T b to q new by a CONNECT operation, which is usually a straight-line connection. If the connection succeeds, then we have found a path connecting q init and q goal. Otherwise, we will switch the roles of T a and T b and let T b perform the EXTEND operation and T a perform the CONNECT operation. The process repeats until a path is found or a maximal number of trials have been reached. The planner described in the previous paragraph performs its search in C. However, it needs to use a balance compensation method to enforce dynamic constraints imposed upon the ZMP trajectory, the modifications to the algorithm are the following: The new configuration in the EXTEND operation first generates a goal configuration q targetl by making an incremental step motion towards q from q near as before. However, q new is generated by filtering the straight-line path connecting q near and q target through the dynamic balance compensator. This creates an incremental dynamically-stable trajectory from q near towards q target. The filter simulation terminates when the configuration converges or after a preset time limit is exceeded. If no collision occurs prior to termination, the most recent configuration output by the filter becomes q new and is added to the tree T. In this way, we are guaranteed that q new C valid. Rather than picking a purely random configuration q rand C at every planning iteration, we pick a random configuration that also happens to correspond to a statically stable posture of the robot, i.e., q rand C stable. The modified EXTEND operation is showed in Figure 5. The main planning loop involves performing a simple iteration in which each step attempts to extend the RRT by adding a new vertex that is biased by a randomly selected stable configuration. EXTEND selects the nearest vertex already in the RRT to the given sample configuration, q. The function 62

4 NEW CONFIG makes a dynamically-stable motion toward q as outlined previously using some fixed incremental distance ε to generate q target. Three situations can occur: Reached, in which q is directly added to the RRT, Advanced, in which a new vertex q new q is added to the RRT; Trapped, in which no new vertex is added due to the inability of the balance compensator to generate an incremental trajectory that lies in C valid. One of the key differences between RRT CONNECT STABLE and the classic RRT- Connect is that instead of uniformly sampling C and growing trees that lie entirely in C free, it attempts to uniformly sample C stable and grow trees that lie within C valid. Figure 6. The learning human behavior by imitation idea. Figure 5. The modified EXTEND processus. We require a method of generating random statically stable postures (random point samples of C stable ). For our implementation, a set of N samples of C stable is generated as a preprocessing step; this computation is specific to the robot Hoap-3 and support-leg configuration, and need only be performed once. The collection of stable postures is saved to a file and loaded into memory when the planner is initialized. B. learning human behavior by imitation Humanoid robots are electro-mechanical systems resembling the morphology of the human body. Consequently, it is very much desired to reproduce ordinary motions like humans. Great efforts have been made already to construct especially walking robots to study bipedal locomotion. The approach to achieve stable gait acquisition in humanoid robots via imitation is depicted in Figure 6. First, a motion capture system transforms Cartesian position of markers attached to the human body to joint angles based on kinematic relationships between the human and robot bodies. Human and HOAP-3 bodies are very different in shape and proportions (see Figure 7). Once the Cartesian coordinates of human head and hands are obtained, it is necessary to normalize these data to HOAP-3 dimensions. Although there are many different normalization techniques [8], for the proposed upper-body imitation system we scale the tracked end-points by a constant factor that takes into account the difference in size between human and robot. Results show that this rough approximation to a normalization process is enough to satisfy the requirements of this purpose. Then, we employ dimensionality reduction to represent posture information in a compact low-dimensional subspace. Optimization of whole-body robot dynamics to match human motion can be performed in the low dimensional space. Particular classes of motion such as walking or kicking are intrinsically low-dimensional. We can apply the well known method of principal components analysis (PCA) to parameterize the low-dimensional motion subspace [7], [9]. The result of linear PCA can be thought of as two linear operators C and C 1 which map from high to low and low to high dimensional spaces respectively. We use a straightforward, standard linear PCA method to map between the low and high-dimensional posture spaces. Vectors in the high-dimensional space are mapped to the low-dimensional space by multiplication with the transformation matrix C. Figure 7. Skeleton hierarchy for the human body and the hoap-3. For the accomplishment of applications in the real robot, we considered that the sensory feedback data can be recorded from the robot during motion and a causal relationship between actions in the low dimensional posture space and the expected sensory feedback is learned. This learned sensory-motor mapping allows humanoid motion 63

5 dynamics to be optimized. An inverse mapping from the reduced space back to the original joint space is then used to generate optimized motion on the robot. We will present results demonstrating that the proposed approach allows a humanoid robot to learn to walk based solely on human motion capture without the need for a detailed physical model of the robot. Recorded kinematic data of human movements were analyzed in order to find geometrical relations among various joint angles characterizing the instantaneous postures. A simplified human body representation leads to dynamics of an underactuated mechanical system with parameters based on anthropometric data. Motion planning for humanoid robots of similar structure can be carried out by considering solutions of reduced dynamics obtained by imposing the virtual holonomic constraints that are found in human movements. IV. SIMULATION RESULTS Planners were implemented on an Intel c Pentium IV processor-based PC running at 2.6 GHz with 2 GB RAM, using C# and OpenGL. An important feature of our system is the use of ODE as a physics engine, and in addition as collision checker. ODE is an open source, high performance library for simulating rigid body dynamics. It has advanced joint types and integrated collision detection with friction. This section presents some preliminary experiments. We have implemented the prototype planners that run within a graphical simulation environment using a dynamic model of the Hoap-3 humanoid robot (28-DOF). Through a graphical user interface, an user can position individual joints or use inverse kinematics to specify body postures. The filter function can be run interactively to ensure that the goal configuration is statically-stable. In Figure 8, the virtual environment of an office is showed; this scene contains furniture within it. It is desired that the robot moves from one desk located in a corner to another desk in the opposite corner. The following scene shows a cafeteria with tables and small decorations; the robot is placed in one of the tables of the scene and requires to plan a collision free trajectory to arrive until the bar. We proposed a motion generation system for the humanoid robot Hoap-3. The motion generated by our system is smooth and stable in the balance. Our system performs various and unrestricted motions for humanoid robots without hard problem in dynamics. Recorded kinematic data of human movements were analyzed in order to find geometrical relations among various joint angles characterizing the instantaneous postures. For motions like sitting down and rising from a chair, the very complex structure of the human body can be reasonably simplified to just three links. Assuming that the feet are fixed parallel to the ground, we can take the first link to Figure 8. Dynamically-stable planned trajectory for a walking motion. be the combined lower legs, the second link to be the combined upper legs and the third link to represent the upper body including arms and head. Of course, we know that humans are fully actuated during the considered motions since the feet act as bases flat on the ground. However, it is reasonable to believe that, although the whole body constitution balances about the ankles, stabilization is mostly done without using torques of the ankle joints, but via synchronization of the other joints. The walking gait on the real robot is not as stable as the results in the simulator because of differences in frictional forces between the simulator and the floor. We expect an improvement in performance when learning is performed directly on the real robot. We note that the learned motion is indeed dynamic and not quasi-static motion because there are only two postures in our walking gait that can be considered statically stable, namely, the two postures in the walking cycle when the two feet of the robot contact the ground. The remaining postures in the walking gait are not 64

6 statically stable as the gait has a fairly fast walking speed. is an important learning mechanism in many biological systems including humans. It is easy to recover kinematic information from human motion using, for example, motion capture, but imitating the motion with stable robot dynamics is a challenging research problem. Traditional model-based approaches based on zero-moment point or the inverted pendulum model require a highly accurate model of robot dynamics and the environment in order to achieve a stable walking gait. REFERENCES [1] K. Hauser, T. Bretl, and J. C. Latombe, Using motion primitives in probabilistic sample-based planning for humanoid robots, In proceedings of the Workshop on the Algorithmic Foundations of Robotics (WAFR), [2] S. Kagami, F. Kanehiro, Y. Tamiya, M. Inaba and H. Inoue, Autobalancer: An online dynamic balance compensation scheme for humanoid robots, Robotics: The Algorithmic Perspective, Workshop on Algorithmic Foundations of Robotics, A K Peters, [3] L. E. Kavraki, P. Svestka, J. C. Latombe and M. H. Overmars, Probabilistic roadmaps for path planning in high-dimensional configuration spaces, IEEE Transactions on Robotics and Automation, Vol. 12, No. 4, pp , [4] J. Kuffner, K. Nishiwaki, S. Kagami, M. Inaba and H. Inoue, Motion planning for humanoid robots, International Symposium of Robotics Research (ISRR03), [5] S. M. LaValle and J. J. Kuffner, Rapidly-exploring random trees: Progress and prospects, Proc. Workshop on the Algorithmic Foundations on Robotics, Figure 9. Dynamically-stable planned trajectory for a walking motion. V. CONCLUSION Humanoid robots are still a young technology with many research challenges. Only few humanoid robots are currently commercially available, often at high costs. Physical prototypes of robots are needed to investigate the complex interactions between robots and humans and to integrate and validate research results from the different research fields involved in humanoid robotics. The development of a humanoid robot platform according to a special target system at the beginning of a research project is often considered a time consuming hindrance. We presented in this paper two algorithms for computing dynamically-stable collision-free motions for humanoid robots given full-body posture goals. Balance constraints are imposed upon incremental search motions computed by a randomized planner in order to maintain the overall dynamic stability of the computed trajectories. Imitation [6] S. M. LaValle and J. J. Kuffner, Randomized kinodynamic planning, The International Journal of Robotics Research, Vol. 20, No. 5, pp , [7] S. Ra, G. Park, C. Kim and B. You, PCA-based genetic operator for evolving movements of humanoid robot, IEEE World Congress on Computational Intelligence, pp , [8] A. Safonova, N. Pollard and J. K. Hodgins, Optimizing human motion for the control of a Humanoid Robot, 2nd International Symposium on Adaptive Motion of Animals and Machines, [9] A. Safonova, J. K. Hodgins and N. S. Pollard, Synthesizing physically realistic human motion in low-dimensional, behavior-specific spaces, ACM SIGGRAPH, pp , [10] T. Sugihara and Y. Nakamura, Whole-boy cooperative balancing of humanoid robot using COG Jacobian, Proc. of the IEEE Int. Conf. on Intelligent Robots and Systems, pp , [11] M. Vukobratović and D. Juricic, Contribution to the synthesis of biped gait, IEEE Transaction on Biomedical Engineering, Vol. 16, No. 1, pp. 1-6,

Vision-based Walking Parameter Estimation for Biped Locomotion Imitation

Vision-based Walking Parameter Estimation for Biped Locomotion Imitation Vision-based Walking Parameter Estimation for Biped Locomotion Imitation Juan Pedro Bandera Rubio 1, Changjiu Zhou 2 and Francisco Sandoval Hernández 1 1 Dpto. Tecnología Electrónica, E.T.S.I. Telecomunicación

More information

Human-like Arm Motion Generation for Humanoid Robots Using Motion Capture Database

Human-like Arm Motion Generation for Humanoid Robots Using Motion Capture Database Human-like Arm Motion Generation for Humanoid Robots Using Motion Capture Database Seungsu Kim, ChangHwan Kim and Jong Hyeon Park School of Mechanical Engineering Hanyang University, Seoul, 133-791, Korea.

More information

This week. CENG 732 Computer Animation. Challenges in Human Modeling. Basic Arm Model

This week. CENG 732 Computer Animation. Challenges in Human Modeling. Basic Arm Model CENG 732 Computer Animation Spring 2006-2007 Week 8 Modeling and Animating Articulated Figures: Modeling the Arm, Walking, Facial Animation This week Modeling the arm Different joint structures Walking

More information

CE801: Intelligent Systems and Robotics Lecture 3: Actuators and Localisation. Prof. Dr. Hani Hagras

CE801: Intelligent Systems and Robotics Lecture 3: Actuators and Localisation. Prof. Dr. Hani Hagras 1 CE801: Intelligent Systems and Robotics Lecture 3: Actuators and Localisation Prof. Dr. Hani Hagras Robot Locomotion Robots might want to move in water, in the air, on land, in space.. 2 Most of the

More information

Frequently Asked Questions

Frequently Asked Questions Frequently Asked Questions Basic Facts What does the name ASIMO stand for? ASIMO stands for Advanced Step in Innovative Mobility. Who created ASIMO? ASIMO was developed by Honda Motor Co., Ltd., a world

More information

Off-line Model Simplification for Interactive Rigid Body Dynamics Simulations Satyandra K. Gupta University of Maryland, College Park

Off-line Model Simplification for Interactive Rigid Body Dynamics Simulations Satyandra K. Gupta University of Maryland, College Park NSF GRANT # 0727380 NSF PROGRAM NAME: Engineering Design Off-line Model Simplification for Interactive Rigid Body Dynamics Simulations Satyandra K. Gupta University of Maryland, College Park Atul Thakur

More information

Design-Simulation-Optimization Package for a Generic 6-DOF Manipulator with a Spherical Wrist

Design-Simulation-Optimization Package for a Generic 6-DOF Manipulator with a Spherical Wrist Design-Simulation-Optimization Package for a Generic 6-DOF Manipulator with a Spherical Wrist MHER GRIGORIAN, TAREK SOBH Department of Computer Science and Engineering, U. of Bridgeport, USA ABSTRACT Robot

More information

Copyright 2011 Casa Software Ltd. www.casaxps.com. Centre of Mass

Copyright 2011 Casa Software Ltd. www.casaxps.com. Centre of Mass Centre of Mass A central theme in mathematical modelling is that of reducing complex problems to simpler, and hopefully, equivalent problems for which mathematical analysis is possible. The concept of

More information

Force/position control of a robotic system for transcranial magnetic stimulation

Force/position control of a robotic system for transcranial magnetic stimulation Force/position control of a robotic system for transcranial magnetic stimulation W.N. Wan Zakaria School of Mechanical and System Engineering Newcastle University Abstract To develop a force control scheme

More information

Figure 3.1.2 Cartesian coordinate robot

Figure 3.1.2 Cartesian coordinate robot Introduction to Robotics, H. Harry Asada Chapter Robot Mechanisms A robot is a machine capable of physical motion for interacting with the environment. Physical interactions include manipulation, locomotion,

More information

Obstacle Avoidance Design for Humanoid Robot Based on Four Infrared Sensors

Obstacle Avoidance Design for Humanoid Robot Based on Four Infrared Sensors Tamkang Journal of Science and Engineering, Vol. 12, No. 3, pp. 249 258 (2009) 249 Obstacle Avoidance Design for Humanoid Robot Based on Four Infrared Sensors Ching-Chang Wong 1 *, Chi-Tai Cheng 1, Kai-Hsiang

More information

Full- day Workshop on Online and offline optimization for humanoid robots. at IEEE IROS 2013 in Tokyo

Full- day Workshop on Online and offline optimization for humanoid robots. at IEEE IROS 2013 in Tokyo Full- day Workshop on Online and offline optimization for humanoid robots at IEEE IROS 2013 in Tokyo Organizers: Eiichi Yoshida, Katja Mombaur, Tom Erez, Yuval Tassa Nov 7, 2013 TALK ABSTRACTS Tamim Asfour

More information

Frequently Asked Questions

Frequently Asked Questions Frequently Asked Questions Basic Facts What does the name ASIMO stand for? ASIMO stands for Advanced Step in Innovative Mobility. Who created ASIMO? ASIMO was developed by Honda Motor Co., Ltd., a world

More information

Operational Space Control for A Scara Robot

Operational Space Control for A Scara Robot Operational Space Control for A Scara Robot Francisco Franco Obando D., Pablo Eduardo Caicedo R., Oscar Andrés Vivas A. Universidad del Cauca, {fobando, pacaicedo, avivas }@unicauca.edu.co Abstract This

More information

Interactive Computer Graphics

Interactive Computer Graphics Interactive Computer Graphics Lecture 18 Kinematics and Animation Interactive Graphics Lecture 18: Slide 1 Animation of 3D models In the early days physical models were altered frame by frame to create

More information

Path Tracking for a Miniature Robot

Path Tracking for a Miniature Robot Path Tracking for a Miniature Robot By Martin Lundgren Excerpt from Master s thesis 003 Supervisor: Thomas Hellström Department of Computing Science Umeå University Sweden 1 Path Tracking Path tracking

More information

Geometric Constraints

Geometric Constraints Simulation in Computer Graphics Geometric Constraints Matthias Teschner Computer Science Department University of Freiburg Outline introduction penalty method Lagrange multipliers local constraints University

More information

DINAMIC AND STATIC CENTRE OF PRESSURE MEASUREMENT ON THE FORCEPLATE. F. R. Soha, I. A. Szabó, M. Budai. Abstract

DINAMIC AND STATIC CENTRE OF PRESSURE MEASUREMENT ON THE FORCEPLATE. F. R. Soha, I. A. Szabó, M. Budai. Abstract ACTA PHYSICA DEBRECINA XLVI, 143 (2012) DINAMIC AND STATIC CENTRE OF PRESSURE MEASUREMENT ON THE FORCEPLATE F. R. Soha, I. A. Szabó, M. Budai University of Debrecen, Department of Solid State Physics Abstract

More information

A Framework for Planning Motion in Environments with Moving Obstacles

A Framework for Planning Motion in Environments with Moving Obstacles Proceedings of the 2007 IEEE/RSJ International Conference on Intelligent Robots and Systems San Diego, CA, USA, Oct 29 - Nov 2, 2007 ThB5.3 A Framework for Planning Motion in Environments with Moving Obstacles

More information

animation animation shape specification as a function of time

animation animation shape specification as a function of time animation animation shape specification as a function of time animation representation many ways to represent changes with time intent artistic motion physically-plausible motion efficiency control typically

More information

Matlab Based Interactive Simulation Program for 2D Multisegment Mechanical Systems

Matlab Based Interactive Simulation Program for 2D Multisegment Mechanical Systems Matlab Based Interactive Simulation Program for D Multisegment Mechanical Systems Henryk Josiński,, Adam Świtoński,, Karol Jędrasiak, Andrzej Polański,, and Konrad Wojciechowski, Polish-Japanese Institute

More information

Force measurement. Forces VECTORIAL ISSUES ACTION ET RÉACTION ISOSTATISM

Force measurement. Forces VECTORIAL ISSUES ACTION ET RÉACTION ISOSTATISM Force measurement Forces VECTORIAL ISSUES In classical mechanics, a force is defined as "an action capable of modifying the quantity of movement of a material point". Therefore, a force has the attributes

More information

INSTRUCTOR WORKBOOK Quanser Robotics Package for Education for MATLAB /Simulink Users

INSTRUCTOR WORKBOOK Quanser Robotics Package for Education for MATLAB /Simulink Users INSTRUCTOR WORKBOOK for MATLAB /Simulink Users Developed by: Amir Haddadi, Ph.D., Quanser Peter Martin, M.A.SC., Quanser Quanser educational solutions are powered by: CAPTIVATE. MOTIVATE. GRADUATE. PREFACE

More information

HYDRAULIC ARM MODELING VIA MATLAB SIMHYDRAULICS

HYDRAULIC ARM MODELING VIA MATLAB SIMHYDRAULICS Engineering MECHANICS, Vol. 16, 2009, No. 4, p. 287 296 287 HYDRAULIC ARM MODELING VIA MATLAB SIMHYDRAULICS Stanislav Věchet, Jiří Krejsa* System modeling is a vital tool for cost reduction and design

More information

Robotics. Chapter 25. Chapter 25 1

Robotics. Chapter 25. Chapter 25 1 Robotics Chapter 25 Chapter 25 1 Outline Robots, Effectors, and Sensors Localization and Mapping Motion Planning Motor Control Chapter 25 2 Mobile Robots Chapter 25 3 Manipulators P R R R R R Configuration

More information

CS 4204 Computer Graphics

CS 4204 Computer Graphics CS 4204 Computer Graphics Computer Animation Adapted from notes by Yong Cao Virginia Tech 1 Outline Principles of Animation Keyframe Animation Additional challenges in animation 2 Classic animation Luxo

More information

Robot Task-Level Programming Language and Simulation

Robot Task-Level Programming Language and Simulation Robot Task-Level Programming Language and Simulation M. Samaka Abstract This paper presents the development of a software application for Off-line robot task programming and simulation. Such application

More information

Synthesizing Animations of Human Manipulation Tasks

Synthesizing Animations of Human Manipulation Tasks Synthesizing Animations of Human Manipulation Tasks Katsu Yamane The University of Tokyo James J. Kuffner Carnegie Mellon University Jessica K. Hodgins Carnegie Mellon University Abstract Even such simple

More information

Blender Notes. Introduction to Digital Modelling and Animation in Design Blender Tutorial - week 9 The Game Engine

Blender Notes. Introduction to Digital Modelling and Animation in Design Blender Tutorial - week 9 The Game Engine Blender Notes Introduction to Digital Modelling and Animation in Design Blender Tutorial - week 9 The Game Engine The Blender Game Engine This week we will have an introduction to the Game Engine build

More information

Introduction to Computer Graphics Marie-Paule Cani & Estelle Duveau

Introduction to Computer Graphics Marie-Paule Cani & Estelle Duveau Introduction to Computer Graphics Marie-Paule Cani & Estelle Duveau 04/02 Introduction & projective rendering 11/02 Prodedural modeling, Interactive modeling with parametric surfaces 25/02 Introduction

More information

View Planning for 3D Object Reconstruction with a Mobile Manipulator Robot

View Planning for 3D Object Reconstruction with a Mobile Manipulator Robot 2014 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS 2014) September 14-18, 2014, Chicago, IL, USA View Planning for 3D Object Reconstruction with a Mobile Manipulator Robot J.

More information

Metrics on SO(3) and Inverse Kinematics

Metrics on SO(3) and Inverse Kinematics Mathematical Foundations of Computer Graphics and Vision Metrics on SO(3) and Inverse Kinematics Luca Ballan Institute of Visual Computing Optimization on Manifolds Descent approach d is a ascent direction

More information

Industrial Walking Systems - A Review

Industrial Walking Systems - A Review Subjects for period of study at LARM in Cassino For stages and thesis developments CONTACT: prof Marco Ceccarelli at Ceccarelli@unicas.it LARM webpage: http://webuser.unicas.it/weblarm/larmindex.htm SUBJECT:

More information

Intersection of a Line and a Convex. Hull of Points Cloud

Intersection of a Line and a Convex. Hull of Points Cloud Applied Mathematical Sciences, Vol. 7, 213, no. 13, 5139-5149 HIKARI Ltd, www.m-hikari.com http://dx.doi.org/1.12988/ams.213.37372 Intersection of a Line and a Convex Hull of Points Cloud R. P. Koptelov

More information

Sampling-Based Motion Planning Using Predictive Models

Sampling-Based Motion Planning Using Predictive Models Sampling-Based Motion Planning Using Predictive Models Brendan Burns and Oliver Brock Laboratory for Perceptual Robotics Department of Computer Science University of Massachusetts Amherst Abstract Robotic

More information

How To Program A Laser Cutting Robot

How To Program A Laser Cutting Robot Robotics ABB Robotics Laser Cutting Software High precision laser cutting made easy - Greater manufacturing flexibility at lower capital investment Robotic laser cutting Overview Allows for the increased

More information

A PAIR OF MEASURES OF ROTATIONAL ERROR FOR AXISYMMETRIC ROBOT END-EFFECTORS

A PAIR OF MEASURES OF ROTATIONAL ERROR FOR AXISYMMETRIC ROBOT END-EFFECTORS A PAIR OF MEASURES OF ROTATIONAL ERROR FOR AXISYMMETRIC ROBOT END-EFFECTORS Sébastien Briot, Ilian A. Bonev Department of Automated Manufacturing Engineering École de technologie supérieure (ÉTS), Montreal,

More information

Intelligent Flexible Automation

Intelligent Flexible Automation Intelligent Flexible Automation David Peters Chief Executive Officer Universal Robotics February 20-22, 2013 Orlando World Marriott Center Orlando, Florida USA Trends in AI and Computing Power Convergence

More information

Classifying Manipulation Primitives from Visual Data

Classifying Manipulation Primitives from Visual Data Classifying Manipulation Primitives from Visual Data Sandy Huang and Dylan Hadfield-Menell Abstract One approach to learning from demonstrations in robotics is to make use of a classifier to predict if

More information

The QOOL Algorithm for fast Online Optimization of Multiple Degree of Freedom Robot Locomotion

The QOOL Algorithm for fast Online Optimization of Multiple Degree of Freedom Robot Locomotion The QOOL Algorithm for fast Online Optimization of Multiple Degree of Freedom Robot Locomotion Daniel Marbach January 31th, 2005 Swiss Federal Institute of Technology at Lausanne Daniel.Marbach@epfl.ch

More information

Short Presentation. Topic: Locomotion

Short Presentation. Topic: Locomotion CSE 888.14 Advanced Computer Animation Short Presentation Topic: Locomotion Kang che Lee 2009 Fall 1 Locomotion How a character moves from place to place. Optimal gait and form for animal locomotion. K.

More information

Lecture L22-2D Rigid Body Dynamics: Work and Energy

Lecture L22-2D Rigid Body Dynamics: Work and Energy J. Peraire, S. Widnall 6.07 Dynamics Fall 008 Version.0 Lecture L - D Rigid Body Dynamics: Work and Energy In this lecture, we will revisit the principle of work and energy introduced in lecture L-3 for

More information

Support Changes during Online Human Motion Imitation by a Humanoid Robot using Task Specification

Support Changes during Online Human Motion Imitation by a Humanoid Robot using Task Specification Support Changes during Online Human Motion Imitation by a Humanoid Robot using Task Specification Louise Penna Poubel 1, Sophie Sakka 2, Denis Ćehajić 3 and Denis Creusot 4 Abstract This paper presents

More information

Motion Planning Strategy for Finding an Object with a Mobile Manipulator in Three-Dimensional Environments

Motion Planning Strategy for Finding an Object with a Mobile Manipulator in Three-Dimensional Environments Motion Planning Strategy for Finding an Object with a Mobile Manipulator in Three-Dimensional Environments Judith Espinoza, Alejandro Sarmiento, Rafael Murrieta-Cid, Seth Hutchinson Centro de Investigación

More information

CATIA V5 Tutorials. Mechanism Design & Animation. Release 18. Nader G. Zamani. University of Windsor. Jonathan M. Weaver. University of Detroit Mercy

CATIA V5 Tutorials. Mechanism Design & Animation. Release 18. Nader G. Zamani. University of Windsor. Jonathan M. Weaver. University of Detroit Mercy CATIA V5 Tutorials Mechanism Design & Animation Release 18 Nader G. Zamani University of Windsor Jonathan M. Weaver University of Detroit Mercy SDC PUBLICATIONS Schroff Development Corporation www.schroff.com

More information

Automated offline programming for robotic welding system with high degree of freedoms

Automated offline programming for robotic welding system with high degree of freedoms University of Wollongong Research Online Faculty of Engineering - Papers (Archive) Faculty of Engineering and Information Sciences 2012 Automated offline programming for robotic welding system with high

More information

Arrangements And Duality

Arrangements And Duality Arrangements And Duality 3.1 Introduction 3 Point configurations are tbe most basic structure we study in computational geometry. But what about configurations of more complicated shapes? For example,

More information

Solving Simultaneous Equations and Matrices

Solving Simultaneous Equations and Matrices Solving Simultaneous Equations and Matrices The following represents a systematic investigation for the steps used to solve two simultaneous linear equations in two unknowns. The motivation for considering

More information

Project 2: Character Animation Due Date: Friday, March 10th, 11:59 PM

Project 2: Character Animation Due Date: Friday, March 10th, 11:59 PM 1 Introduction Project 2: Character Animation Due Date: Friday, March 10th, 11:59 PM The technique of motion capture, or using the recorded movements of a live actor to drive a virtual character, has recently

More information

Sensory-motor control scheme based on Kohonen Maps and AVITE model

Sensory-motor control scheme based on Kohonen Maps and AVITE model Sensory-motor control scheme based on Kohonen Maps and AVITE model Juan L. Pedreño-Molina, Antonio Guerrero-González, Oscar A. Florez-Giraldo, J. Molina-Vilaplana Technical University of Cartagena Department

More information

Practice Exam Three Solutions

Practice Exam Three Solutions MASSACHUSETTS INSTITUTE OF TECHNOLOGY Department of Physics Physics 8.01T Fall Term 2004 Practice Exam Three Solutions Problem 1a) (5 points) Collisions and Center of Mass Reference Frame In the lab frame,

More information

Chapter 10 Rotational Motion. Copyright 2009 Pearson Education, Inc.

Chapter 10 Rotational Motion. Copyright 2009 Pearson Education, Inc. Chapter 10 Rotational Motion Angular Quantities Units of Chapter 10 Vector Nature of Angular Quantities Constant Angular Acceleration Torque Rotational Dynamics; Torque and Rotational Inertia Solving Problems

More information

- 2.12 Lecture Notes - H. Harry Asada Ford Professor of Mechanical Engineering

- 2.12 Lecture Notes - H. Harry Asada Ford Professor of Mechanical Engineering - 2.12 Lecture Notes - H. Harry Asada Ford Professor of Mechanical Engineering Fall 2005 1 Chapter 1 Introduction Many definitions have been suggested for what we call a robot. The word may conjure up

More information

Probabilistic Path Planning

Probabilistic Path Planning Probabilistic Path Planning P. Švestka M. H. Overmars This is the fifth chapter of the book: Robot Motion Planning and Control Jean-Paul Laumond (Editor) Laboratoire d Analye et d Architecture des Systèmes

More information

PLANE TRUSSES. Definitions

PLANE TRUSSES. Definitions Definitions PLANE TRUSSES A truss is one of the major types of engineering structures which provides a practical and economical solution for many engineering constructions, especially in the design of

More information

Figure 1. The Ball and Beam System.

Figure 1. The Ball and Beam System. BALL AND BEAM : Basics Peter Wellstead: control systems principles.co.uk ABSTRACT: This is one of a series of white papers on systems modelling, analysis and control, prepared by Control Systems Principles.co.uk

More information

2.5 Physically-based Animation

2.5 Physically-based Animation 2.5 Physically-based Animation 320491: Advanced Graphics - Chapter 2 74 Physically-based animation Morphing allowed us to animate between two known states. Typically, only one state of an object is known.

More information

LEGO NXT-based Robotic Arm

LEGO NXT-based Robotic Arm Óbuda University e Bulletin Vol. 2, No. 1, 2011 LEGO NXT-based Robotic Arm Ákos Hámori, János Lengyel, Barna Reskó Óbuda University barna.resko@arek.uni-obuda.hu, hamoriakos@gmail.com, polish1987@gmail.com

More information

Simulation of Trajectories and Comparison of Joint Variables for Robotic Manipulator Using Multibody Dynamics (MBD)

Simulation of Trajectories and Comparison of Joint Variables for Robotic Manipulator Using Multibody Dynamics (MBD) Simulation of Trajectories and Comparison of Joint Variables for Robotic Manipulator Using Multibody Dynamics (MBD) Jatin Dave Assistant Professor Nirma University Mechanical Engineering Department, Institute

More information

Physics: Principles and Applications, 6e Giancoli Chapter 2 Describing Motion: Kinematics in One Dimension

Physics: Principles and Applications, 6e Giancoli Chapter 2 Describing Motion: Kinematics in One Dimension Physics: Principles and Applications, 6e Giancoli Chapter 2 Describing Motion: Kinematics in One Dimension Conceptual Questions 1) Suppose that an object travels from one point in space to another. Make

More information

Teaching Methodology for 3D Animation

Teaching Methodology for 3D Animation Abstract The field of 3d animation has addressed design processes and work practices in the design disciplines for in recent years. There are good reasons for considering the development of systematic

More information

An Instructional Aid System for Driving Schools Based on Visual Simulation

An Instructional Aid System for Driving Schools Based on Visual Simulation An Instructional Aid System for Driving Schools Based on Visual Simulation Salvador Bayarri, Rafael Garcia, Pedro Valero, Ignacio Pareja, Institute of Traffic and Road Safety (INTRAS), Marcos Fernandez

More information

GAIT DEVELOPMENT FOR THE TYROL BIPED ROBOT

GAIT DEVELOPMENT FOR THE TYROL BIPED ROBOT Proceedings of ECTC 2007 2007 ASME Early Career Technical Conference October 5-6, 2007, Miami, Florida USA GAIT DEVELOPMENT FOR THE TYROL BIPED ROBOT Vishnu Madadi, Mehmet Ismet Can Dede, and Sabri Tosunoglu

More information

CIM Computer Integrated Manufacturing

CIM Computer Integrated Manufacturing INDEX CIM IN BASIC CONFIGURATION CIM IN ADVANCED CONFIGURATION CIM IN COMPLETE CONFIGURATION DL CIM A DL CIM B DL CIM C DL CIM C DL CIM B DL CIM A Computer Integrated Manufacturing (CIM) is a method of

More information

Solving Geometric Problems with the Rotating Calipers *

Solving Geometric Problems with the Rotating Calipers * Solving Geometric Problems with the Rotating Calipers * Godfried Toussaint School of Computer Science McGill University Montreal, Quebec, Canada ABSTRACT Shamos [1] recently showed that the diameter of

More information

CALIBRATION OF A ROBUST 2 DOF PATH MONITORING TOOL FOR INDUSTRIAL ROBOTS AND MACHINE TOOLS BASED ON PARALLEL KINEMATICS

CALIBRATION OF A ROBUST 2 DOF PATH MONITORING TOOL FOR INDUSTRIAL ROBOTS AND MACHINE TOOLS BASED ON PARALLEL KINEMATICS CALIBRATION OF A ROBUST 2 DOF PATH MONITORING TOOL FOR INDUSTRIAL ROBOTS AND MACHINE TOOLS BASED ON PARALLEL KINEMATICS E. Batzies 1, M. Kreutzer 1, D. Leucht 2, V. Welker 2, O. Zirn 1 1 Mechatronics Research

More information

SimFonIA Animation Tools V1.0. SCA Extension SimFonIA Character Animator

SimFonIA Animation Tools V1.0. SCA Extension SimFonIA Character Animator SimFonIA Animation Tools V1.0 SCA Extension SimFonIA Character Animator Bring life to your lectures Move forward with industrial design Combine illustrations with your presentations Convey your ideas to

More information

Original research papers

Original research papers Pol. J. Sport Tourism, 9, 8-7 DOI:.78/v97---z 8 Original research papers THE IMPACT OF ANKLE JOINT STIFFENING BY SKI EQUIPMENT ON MAINTENANCE OF BODY BALANCE The impact of ski equipment on body balance

More information

MOBILE ROBOT TRACKING OF PRE-PLANNED PATHS. Department of Computer Science, York University, Heslington, York, Y010 5DD, UK (email:nep@cs.york.ac.

MOBILE ROBOT TRACKING OF PRE-PLANNED PATHS. Department of Computer Science, York University, Heslington, York, Y010 5DD, UK (email:nep@cs.york.ac. MOBILE ROBOT TRACKING OF PRE-PLANNED PATHS N. E. Pears Department of Computer Science, York University, Heslington, York, Y010 5DD, UK (email:nep@cs.york.ac.uk) 1 Abstract A method of mobile robot steering

More information

Véronique PERDEREAU ISIR UPMC 6 mars 2013

Véronique PERDEREAU ISIR UPMC 6 mars 2013 Véronique PERDEREAU ISIR UPMC mars 2013 Conventional methods applied to rehabilitation robotics Véronique Perdereau 2 Reference Robot force control by Bruno Siciliano & Luigi Villani Kluwer Academic Publishers

More information

Chapter 1. Introduction. 1.1 The Challenge of Computer Generated Postures

Chapter 1. Introduction. 1.1 The Challenge of Computer Generated Postures Chapter 1 Introduction 1.1 The Challenge of Computer Generated Postures With advances in hardware technology, more powerful computers become available for the majority of users. A few years ago, computer

More information

Distributed Dynamic Load Balancing for Iterative-Stencil Applications

Distributed Dynamic Load Balancing for Iterative-Stencil Applications Distributed Dynamic Load Balancing for Iterative-Stencil Applications G. Dethier 1, P. Marchot 2 and P.A. de Marneffe 1 1 EECS Department, University of Liege, Belgium 2 Chemical Engineering Department,

More information

C O M P U C O M P T U T E R G R A E R G R P A H I C P S Computer Animation Guoying Zhao 1 / 66 /

C O M P U C O M P T U T E R G R A E R G R P A H I C P S Computer Animation Guoying Zhao 1 / 66 / Computer Animation Guoying Zhao 1 / 66 Basic Elements of Computer Graphics Modeling construct the 3D model of the scene Rendering Render the 3D model, compute the color of each pixel. The color is related

More information

Modelling 3D Avatar for Virtual Try on

Modelling 3D Avatar for Virtual Try on Modelling 3D Avatar for Virtual Try on NADIA MAGNENAT THALMANN DIRECTOR MIRALAB UNIVERSITY OF GENEVA DIRECTOR INSTITUTE FOR MEDIA INNOVATION, NTU, SINGAPORE WWW.MIRALAB.CH/ Creating Digital Humans Vertex

More information

Tutorial: Biped Character in 3D Studio Max 7, Easy Animation

Tutorial: Biped Character in 3D Studio Max 7, Easy Animation Tutorial: Biped Character in 3D Studio Max 7, Easy Animation Written by: Ricardo Tangali 1. Introduction:... 3 2. Basic control in 3D Studio Max... 3 2.1. Navigating a scene:... 3 2.2. Hide and Unhide

More information

Slow Tree Climbing Robot Analysis of Performance

Slow Tree Climbing Robot Analysis of Performance Slow Tree Climbing Robot Analysis of Performance Prakash Karamari 1, Prajwal Subbhapurmath 2 1Student, Department of Industrial and Production engineering, B.V.Bhoomaraddi college of engineering and technology,

More information

Human Skeletal and Muscle Deformation Animation Using Motion Capture Data

Human Skeletal and Muscle Deformation Animation Using Motion Capture Data Human Skeletal and Muscle Deformation Animation Using Motion Capture Data Ali Orkan Bayer Department of Computer Engineering, Middle East Technical University 06531 Ankara, Turkey orkan@ceng.metu.edu.tr

More information

Conceptual Questions: Forces and Newton s Laws

Conceptual Questions: Forces and Newton s Laws Conceptual Questions: Forces and Newton s Laws 1. An object can have motion only if a net force acts on it. his statement is a. true b. false 2. And the reason for this (refer to previous question) is

More information

Computer Animation. Lecture 2. Basics of Character Animation

Computer Animation. Lecture 2. Basics of Character Animation Computer Animation Lecture 2. Basics of Character Animation Taku Komura Overview Character Animation Posture representation Hierarchical structure of the body Joint types Translational, hinge, universal,

More information

Mechanism and Control of a Dynamic Lifting Robot

Mechanism and Control of a Dynamic Lifting Robot Mechanism and Control of a Dynamic Lifting Robot T. Uenoa, N. Sunagaa, K. Brownb and H. Asada' 'Institute of Technology, Shimizu Corporation, Etchujima 3-4-17, Koto-ku, Tokyo 135, Japan 'Department of

More information

THEORETICAL MECHANICS

THEORETICAL MECHANICS PROF. DR. ING. VASILE SZOLGA THEORETICAL MECHANICS LECTURE NOTES AND SAMPLE PROBLEMS PART ONE STATICS OF THE PARTICLE, OF THE RIGID BODY AND OF THE SYSTEMS OF BODIES KINEMATICS OF THE PARTICLE 2010 0 Contents

More information

INTERACTIVELY RESPONSIVE ANIMATION OF HUMAN WALKING IN VIRTUAL ENVIRONMENTS

INTERACTIVELY RESPONSIVE ANIMATION OF HUMAN WALKING IN VIRTUAL ENVIRONMENTS INTERACTIVELY RESPONSIVE ANIMATION OF HUMAN WALKING IN VIRTUAL ENVIRONMENTS By Shih-kai Chung B.A. June 1988, National Taiwan University, Taiwan M.S. May 1994, The George Washington University A Dissertation

More information

Behavioral Animation Modeling in the Windows Environment

Behavioral Animation Modeling in the Windows Environment Behavioral Animation Modeling in the Windows Environment MARCELO COHEN 1 CARLA M. D. S. FREITAS 1 FLAVIO R. WAGNER 1 1 UFRGS - Universidade Federal do Rio Grande do Sul CPGCC - Curso de Pós Graduação em

More information

Motion Retargetting and Transition in Different Articulated Figures

Motion Retargetting and Transition in Different Articulated Figures Motion Retargetting and Transition in Different Articulated Figures Ming-Kai Hsieh Bing-Yu Chen Ming Ouhyoung National Taiwan University lionkid@cmlab.csie.ntu.edu.tw robin@ntu.edu.tw ming@csie.ntu.edu.tw

More information

High Accuracy Articulated Robots with CNC Control Systems

High Accuracy Articulated Robots with CNC Control Systems Copyright 2012 SAE International 2013-01-2292 High Accuracy Articulated Robots with CNC Control Systems Bradley Saund, Russell DeVlieg Electroimpact Inc. ABSTRACT A robotic arm manipulator is often an

More information

In order to describe motion you need to describe the following properties.

In order to describe motion you need to describe the following properties. Chapter 2 One Dimensional Kinematics How would you describe the following motion? Ex: random 1-D path speeding up and slowing down In order to describe motion you need to describe the following properties.

More information

Worksheet #1 Free Body or Force diagrams

Worksheet #1 Free Body or Force diagrams Worksheet #1 Free Body or Force diagrams Drawing Free-Body Diagrams Free-body diagrams are diagrams used to show the relative magnitude and direction of all forces acting upon an object in a given situation.

More information

Design of a Universal Robot End-effector for Straight-line Pick-up Motion

Design of a Universal Robot End-effector for Straight-line Pick-up Motion Session Design of a Universal Robot End-effector for Straight-line Pick-up Motion Gene Y. Liao Gregory J. Koshurba Wayne State University Abstract This paper describes a capstone design project in developing

More information

animation shape specification as a function of time

animation shape specification as a function of time animation 1 animation shape specification as a function of time 2 animation representation many ways to represent changes with time intent artistic motion physically-plausible motion efficiency typically

More information

Improved Mecanum Wheel Design for Omni-directional Robots

Improved Mecanum Wheel Design for Omni-directional Robots Proc. 2002 Australasian Conference on Robotics and Automation Auckland, 27-29 November 2002 Improved Mecanum Wheel Design for Omni-directional Robots Olaf Diegel, Aparna Badve, Glen Bright, Johan Potgieter,

More information

Robot coined by Karel Capek in a 1921 science-fiction Czech play

Robot coined by Karel Capek in a 1921 science-fiction Czech play Robotics Robot coined by Karel Capek in a 1921 science-fiction Czech play Definition: A robot is a reprogrammable, multifunctional manipulator designed to move material, parts, tools, or specialized devices

More information

Sensor Based Control of Autonomous Wheeled Mobile Robots

Sensor Based Control of Autonomous Wheeled Mobile Robots Sensor Based Control of Autonomous Wheeled Mobile Robots Gyula Mester University of Szeged, Department of Informatics e-mail: gmester@inf.u-szeged.hu Abstract The paper deals with the wireless sensor-based

More information

Part-Based Recognition

Part-Based Recognition Part-Based Recognition Benedict Brown CS597D, Fall 2003 Princeton University CS 597D, Part-Based Recognition p. 1/32 Introduction Many objects are made up of parts It s presumably easier to identify simple

More information

Robotics. Lecture 3: Sensors. See course website http://www.doc.ic.ac.uk/~ajd/robotics/ for up to date information.

Robotics. Lecture 3: Sensors. See course website http://www.doc.ic.ac.uk/~ajd/robotics/ for up to date information. Robotics Lecture 3: Sensors See course website http://www.doc.ic.ac.uk/~ajd/robotics/ for up to date information. Andrew Davison Department of Computing Imperial College London Review: Locomotion Practical

More information

Lecture L2 - Degrees of Freedom and Constraints, Rectilinear Motion

Lecture L2 - Degrees of Freedom and Constraints, Rectilinear Motion S. Widnall 6.07 Dynamics Fall 009 Version.0 Lecture L - Degrees of Freedom and Constraints, Rectilinear Motion Degrees of Freedom Degrees of freedom refers to the number of independent spatial coordinates

More information

UNIT 1 INTRODUCTION TO NC MACHINE TOOLS

UNIT 1 INTRODUCTION TO NC MACHINE TOOLS UNIT 1 INTRODUCTION TO NC MACHINE TOOLS Structure 1.1 Introduction Objectives 1.2 NC Machines 1.2.1 Types of NC Machine 1.2.2 Controlled Axes 1.2.3 Basic Components of NC Machines 1.2.4 Problems with Conventional

More information

Intuitive Navigation in an Enormous Virtual Environment

Intuitive Navigation in an Enormous Virtual Environment / International Conference on Artificial Reality and Tele-Existence 98 Intuitive Navigation in an Enormous Virtual Environment Yoshifumi Kitamura Shinji Fukatsu Toshihiro Masaki Fumio Kishino Graduate

More information

Simulating the Structural Evolution of Software

Simulating the Structural Evolution of Software Simulating the Structural Evolution of Software Benjamin Stopford 1, Steve Counsell 2 1 School of Computer Science and Information Systems, Birkbeck, University of London 2 School of Information Systems,

More information

Two hours UNIVERSITY OF MANCHESTER SCHOOL OF COMPUTER SCIENCE. M.Sc. in Advanced Computer Science. Friday 18 th January 2008.

Two hours UNIVERSITY OF MANCHESTER SCHOOL OF COMPUTER SCIENCE. M.Sc. in Advanced Computer Science. Friday 18 th January 2008. COMP60321 Two hours UNIVERSITY OF MANCHESTER SCHOOL OF COMPUTER SCIENCE M.Sc. in Advanced Computer Science Computer Animation Friday 18 th January 2008 Time: 09:45 11:45 Please answer any THREE Questions

More information

Chapter. 4 Mechanism Design and Analysis

Chapter. 4 Mechanism Design and Analysis Chapter. 4 Mechanism Design and Analysis 1 All mechanical devices containing moving parts are composed of some type of mechanism. A mechanism is a group of links interacting with each other through joints

More information