Planning Cooperative Motions for Animated Characters

Size: px
Start display at page:

Download "Planning Cooperative Motions for Animated Characters"

Transcription

1 Planning Cooperative Motions for Animated Characters Claudia Esteves Gustavo Arechavaleta Jean-Paul Laumond 7, avenue du Colonel Roche, Toulouse Abstract This paper presents a motion planning scheme to plan, generate and edit motions for two or more virtual characters in cluttered environments. The main challenge is to deal with 3D collision avoidance while preserving the believability of the agent behaviors. To accomplish a coordinated task a geometrical decoupling of the system is proposed. Several techniques such as probabilistic path planning for open and closed kinematic chains, motion controllers and motion editing are integrated within a same algorithmic framework. 1 Introduction The interaction between the fields of robotics and computer animation is not new. The human figure has been frequently represented in computer animation with the articulated mechanisms used in robotics to control manipulators [1]. With this common representation, many techniques have been developed within both fields having two different goals in mind: On one hand, applications of computer animation mainly in the entertainment industry have made it necessary to develop techniques that generate realistic-looking motions. On the other hand the interest in motions from a robotics point of view is to generate them automatically without caring for realism. In recent years, arising applications in both areas (e.g. ergonomics, interactive video games, etc.) have interested researchers in automatically generating human-like plausible motions. With such a motivation, several approaches to automatically plan motions for a human mannequin have been developed. These works have focused in animating a given behavior at a time. For instance, in [6] the authors make a virtual mannequin perform manipulation planning. Another approach using an automated footprint planner that deals with locomotion on rough terrains is described in [2]. A two-step path planner for walking virtual characters was proposed in [8]. This approach consists in planning a collision-free path for a cylinder in a 2D world and then animating the mannequin along the path. This idea of planner was extended in [12] in order to deal with 3D obstacle avoidance and produce eye-believable motions. In the same spirit, this work combines techniques issued from robotics and computer animation into a single motion planning scheme accounting for two behaviors: locomotion and manipulation. Here, the main challenge is to deal with 3D collision avoidance while preserving the believability of the motions and allowing cooperation between two or more virtual mannequins. In order to achieve this, we define a simplified model of the task (walking while carrying a bulky object) by performing a geometric and kinematical decomposition of the systems degrees of freedom (DOF). This task model is extended to allow the cooperation between characters by automatically computing an approximation of the so-called reachable cooperative space. The remaining of this paper is structured as follows: In Section 2 a brief overview of the techniques used in this work is presented. In Section 3 the system and the task models are described. Section 4 describes how all techniques are combined in a 3-step algorithm in order to obtain an animation. In Section 5, examples of individual and cooperative tasks are shown and discussed. Finally, conclusion and future work are presented in Section 6. 2 Techniques Overview In order to generate complete motion sequences of one or more virtual mannequins transporting a bulky object in a cluttered environment we use three main components: a motion planner that handles open and closed kinematic chains motion controllers adapted for virtual human mannequins a 3D collision-avoidance editing strategy. There are many techniques that could be used to cover these requirements. In the paragraphs below, we describe the techniques that we think are best adapted to our problem.

2 2.1 Probabilistic Motion Planning Techniques Probabilistic Roadmaps The interest of this method is to obtain a representation of the topology of the collision-free space in a compact data structure called a roadmap. Such a structure is computed without requiring an explicit representation of the obstacles. A roadmap can be obtained by using two types of algorithms: sampling or diffusion. The main idea of the first techniques (e.g. PRM [5]) is to sample random configuration lying in the free space and to trace edges to connect them with neighbor samples. Edges or local paths should also be collision-free and their form depends on the kinematical constraints (steering method) of the moving device. The diffusion techniques [9] consist in sampling the collision-free space with only few configurations called roots and to diffuse the exploration in the neighborhoods to randomly chosen directions. In this work we use a variant of the first approach: the Visibility PRM [14]. In this method, there are two types of nodes: the guards and the connexions. Nodes are added if they are not visible from previous sampled nodes or if they allow to link two or more connected components of the roadmap. The kind of roadmap generated with this approach is more compact than the one obtained using the PRM alone Planning for open-kinematic chains A motion path can be found in a roadmap by using a two-step algorithm consisting on a learning and a query phase. For an articulated mechanism, the roadmap is computed in the learning phase by generating random configurations within the allowed range of each DOF. In the query phase, the initial and final configurations are added as new nodes in the roadmap and connected with an adapted steering method. Then, a graph search is performed to find a collision-free path between the starting and goal configurations. If a path is found it is then converted into a trajectory (a time-parameterized path) Planning for closed-kinematic chains In order to handle the motions of closed kinematic mechanisms, some path planning methods have been proposed in the literature [10, 4, 3]. In our work we have chosen to use the Random Loop Generator (RLG) algorithm proposed in [3]. For applying such method a closed kinematic chain is divided in active and passive parts. The main idea of the algorithm is to decrease the complexity of the closed kinematic chain at each iteration until the active part becomes reachable by all passive chain segments simultaneously. The reachable workspace of a kinematic chain is defined as the volume which the end-effector can reach. An approximation of this volume is automatically computed by the RLG using a simple bounding volume (spherical shell) consisting on the intersection of concentric spheres and cones. A guided random sampling of the configurations of the active part is done inside the computed shell and within the current joint limits. When several loops are present in the mechanism, they are treated as separate closed chains. Once the roadmap is constructed, a path is found in the same way as for open kinematic chains. 2.2 Motion Generation Techniques Kinematics based methods Kinematics based techniques specify motion independently of the underlying forces that produced them. Motion can either be defined by specifying the value of each joint (forward-kinematics) or it can be derived from a given end-effector configuration (inversekinematics). In this work we are especially interested in generating the motions of virtual human characters. In computer animation this approach has been frequently used to generate the motions of articulated human characters as in [18]. Several inverse kinematics (IK) algorithms for 7-DOF anthropomorphic limbs have been developed based on biomechanical data in order to best reproduce human-arm motions (e.g. [7, 15]). In our work we have chosen to use the combined analytic and numerical IK method presented in [15]. Kinematics-based methods are well adapted when a specified target is given (like in reaching motions) but generating believable motions is often problematic Motion capture based methods Motion capture allows a rapid generation of character motions and it has been widely used in interactive and real-time applications. The idea of these kind of techniques is to record human motions by placing sensors in the subjects body and apply them later to a synthetic model [11]. Motion libraries are built by filtering and characterizing the data obtained from the recorded motions. One particular motion at a time is later chosen from the library. The disadvantage of these techniques is that, when used alone, the kind of motion generated cannot be adapted or reused.

3 2.2.3 Motion Editing Techniques When a limited set of data is available, like in a motion capture library, there is a need to expand the set of possible motions in order to produce an animation. Interpolation methods to modify, combine and adapt these motions have been developed to overcome this necessity. For example in [17] motion parameters are represented in curves which are blended in order to combine motions. In [16] the authors extract the motion characteristics from original data and define a functional model based of Fourier series expansion. This is done in order to interpolate or extrapolate human locomotion and generate emotion-based animations. These methods deal with the generation of new motions while preserving the qualities of the original ones such as realism and expressiveness. 3 System and Task Modeling Our system can be composed of one or several human or robot mannequins. All characters are modeled as a hierarchy of rigid bodies connected by constrained links trying to reproduce (in the case of human mannequins) the human joint limits. Human mannequins are modeled with 53 DOF in 18 spherical and rotational joints arranged in a tree structure of 5 kinematical chains that converge in the characters pelvis (Figure 1). Here, we consider locomotion and manipulation as the robots basic complementary behaviors. In order to combine them we perform a geometrical decoupling of the systems DOF according to their main function. The mannequins are thus divided in three DOF groups: Locomotion, Grasp and Mobility. Figure 1: DOF are decomposed into three groups accoring to their function: locomotion, mobility and grasp. The Locomotion (resp. Grasp) DOF are those involved in producing the walking (resp. manipulating) behavior on the virtual mannequin. The Mobility group contains the DOF that allow a complementary posture control to the specified behaviors. In our virtual mannequin these are the DOF located in the head and spine. This geometrical decoupling strategy is fundamental in our approach because in this way a reduced system model can be employed to simplify the control and description of the current task. As we are aiming for two mannequins to interact with each other in the manipulation behavior, a geometrical decoupling of the system is not enough to describe the cooperative task. In the paragraphs below the strategy to compute a reachable cooperative space that allows to complete the task description is described. As it can be seen in Figure 2, when two virtual mannequins hold the same object, several closed kinematic loops are formed. In this case, the system is considered as a multiple-loop articulated mechanism and treated with the RLG technique overviewed in Section Figure 2: Closed kinematic chains are formed in cooperative manipulation For a single human mannequin, the arms inverse kinematics algorithm defines the range of its reachable space. This space is automatically aproximated by using the spherical shells volume. For a cooperative task, the reachable cooperative space is considered to be the intersection of all the individual spaces (Figure 3a). In Figure 3b it is seen that even though the individual reachable spaces are not intersecting, a cooperative reachable space approximation is computed using the large object as the end-effector of each kinematic chain.

4 (a) Figure 3: Individual reachable spaces are intersected to obtain a cooperative space for manipulation. (b) 4 Algorithm Our algorithm consists on three stages: 1. Plan a collision-free trajectory for a reduced model of the system 2. Animate locomotion and manipulation behaviors in parallel 3. Edit the generated motions to avoid residual collisions. The user-specified inputs for the algorithm are: a geometric and kinematical description of the system maximal linear velocity and acceleration number of desired frames in the animation a motion library containing captured data from different walking sequences an initial and a final configuration. The output is an animated sequence of the combined behaviors. In the next paragraphs each step of the algorithm is described. 4.1 Motion planning In this step a simplified model of the system is employed in order to reduce the complexity of the planning problem. For this, each mannequin locomotion DOF are covered with a bounding box as seen on Figure 4. In this example a 12-DOF reduced system is obtained with 6 parameters to specify the mannequin position and orientation and the other 6 to specify Figure 4: Simplified model used for planning a trajectory. the object motions. With this model a collision-free path is found using the probabilistic roadmap method described in Section In this work we have considered that smooth human-like paths can be approximated to Bezier curves of third degree but other local paths could be used instead. Once a collision-free path is found, it is then transformed into a set of discrete time-stamped positions (animation frames), which is the input to the next step of the algorithm. 4.2 Motion generation In this step, locomotion and manipulation behaviors are synthesized in parallel using the complete model of the system. The locomotion controller described in [12], uses motion-capture editing techniques in order to combine different walking cycles from the library and to adapt them to the velocity and acceleration constrained trajectory. Here, the walking behavior will set the joint values for the locomotion and mobility DOF leaving the grasp DOF inanimated. The grasping behavior is separately animated applying a 7-DOF inverse kinematics. This, to reach the valued imposed by the object configurations along the trajectory defined in the planning step. In this process only the grasp DOF values are specified. 4.3 Motion editing In the first step of the algorithm, only a system involving the lower part of the mannequins was considered. Therefore, the generated trajectory allows residual collisions with the remaining DOF (mobility and grasp). The purpose of this last step is to solve these possible remaining collisions while preserving the believability of the generated motions. Collisions with the mobility and grasping DOF are treated differently depending on the nature of the kinematic chains that contains them (open or closed).

5 International Symposium on Robotics and Automation 2004 Quere taro, Me xico In the case of an open kinematic chain (head-spine), a local deformation of the chain is performed until a valid (collision-free) configuration is reached. Thereafter, a warping method is applied to obtain the minimal deformation and preserve the smoothness of the motions. When collisions are found in a closed chain (armsobject) a new local collision-free path is found for the chain and the same warping method is applied. If at this stage there are no collision-free configurations found, the computed trajectory is invalidated and a new one is found. 5 Experimental Results We have implemented our algorithm within the software platform Move3D [13] developed at LAAS. We have generated different animations with different environments varying their size and complexity. Two types of virtual mannequins have been used. In the paragraphs below, two examples are presented and discussed. 5.1 Pizza Delivery Service In this example the virtual pizza delivery boy has to take a pizza from one office to another (Figure 5). Here, we would like the mannequin to keep the boxes horizontal along the trajectory to prevent the pizzas to loose their ingredients. For this, we impose kinematical constraints by restricting two of the six DOF for the free-flying object. This means that in roll-pitchyaw angle representation we have removed the DOF allowing the object to pitch and roll. Figure 6: Selected configurations of the computed trajectory. mannequin s arm and the bookshelf at the second office entrance. In this case a solution was quickly found by modifying the elbows configuration as it is shown in Figure 7. Here, this collision was not likely to be avoided in the original path because the doorways are narrow and the bookshelf is very near the final configuration. Figure 7: The mannequin moves his elbow in order to avoid collision with the bookshelf. Figure 5: Initial and final configurations 5.2 Once the initial and final configurations, velocity and acceleration constraints and the number of frames are specified by the user, the algorithm is applied and the animation generated. In Figure 6 the resulting trajectory is shown as a sequence of configurations selected for image clarity. After the locomotion and grasping behaviors were generated, a residual collision was found between the In the factory The second example takes place in a typical industrial environment. Here a heavy plate has to be transported across the room by a human mannequin along with a virtual robot manipulator (Figure 8). As it can be seen, the environment is complex, it contains plenty of obstacles and collisions are likely to occur. The drums lying around the room leave only one collision-free pathway for the system to traverse.

6 Table 1: Computational time in seconds. Stage Office Factory Figure 8: Virtual mannequins cooperating in the industrial facilities. No. Frames Stages I. Planning - Path Trajectory II. Animating - Locomotion Manipulation III. Editing Total time In the first step of our algorithm this collision-free path is found and sampled. Then, locomotion and cooperative grasping behaviors are synthesized. Here, the virtual robot is considered to be holonomic, so a straight line was used as steering method. In the tuning step, several residual collisions were found and avoided. Some frames of the final animation are shown in Figure 9. Figure 9: The agents deal with several obstacles while transporting the plate. 5.3 Computational time Both examples were computed on a Sun-Blade-100 workstation wih a 500MHz UltraSparc-IIe processor and 512 Mb in RAM. For the first example, the office environment is composed of 148,977 polygons, all of them taking part in the collision test. The industrial environment is composed of 159,698 polygons but only the lower (mannequin height) 92,787 take part in collision testing. Table 1 presents the time needed to compute each of the examples considering a pre-computed roadmap (i.e. only the query phase). The time it took to build this roadmap was 1.69 sec. for the office and 31.4 sec. for the factory. At this stage, the time varies with the complexity of the environment and given its the probabilistic nature of the algorithm. Two different animations were generated for each trajectory in the industrial environment and one in the office. We can see that the time to compute the trajectory in the factory is higher than in the office because there are two agents in the scene, and there are more obstacles to avoid and the distance between the initial and final configurations is greater. The time it takes to synthesize locomotion and manipulation behaviors is clearly proportional to the number of frames in the animation. The edition-step computing time depends on the number of residual collisions found along the trajectory. 6 Conclusions We presented an approach to plan, generate and edit collision-free motions for cooperating virtual characters handling bulky objects. To accomplish this task a geometric decoupling of the system is proposed. A three-step algorithm that integrates several techniques such as motion planning algorithms, motion controllers and motion editing techniques is described. This approach works well to cope with complementary behaviors such as locomotion and manipulation where different DOF are used for each of them. This approach should be extended in order to generate a larger set of behaviors. A major component of realistic motion, which is not considered in this work is physically-based reaction to commonly encountered forces. Work should be done in order to integrate this in our current motion planning scheme. This is one of our near-future goals. At this stage, manipulation planning is not considered. This problem has been previously tackled in [6]. However, more complicated instances of this problem

7 should be considered in order to plan the motions of several interacting arms. Animations related to this work can be found at RIA-research-motion-character.html Acknowledgment C. Esteves and G. Arechavaleta benefit from SFERE-CONACyT grants. This work is partially funded by the European Community Projects FP5 IST Movie and FP6 IST Cogniron. [9] S. LaValle, Rapidly-exploring random trees: A new tool for path planning, Computer Science Department. Iowa State University, Tech. Rep., October [10] S. LaValle, J. H. Yakey, and L. E. Kavraki, A probabilistic roadmap approach for systems with closed kinematic chains, in Proc. IEEE Transactions on Robotics and Automation, [11] R. Parent, Computer Animation: Algorithms and Techniques. The Ohio State University: Morgan- Kaufmann Publishers, References [1] N. Badler, C. Phillips, and B. Webber, Simulating Humans: Computer Graphics, Animation, and Control. University of Pennsylvania, Philadelphia: Oxford University Press, [2] M. Choi, J. Lee, and S. Shin, Planning biped locomotion using motion capture data and probabilistic roadmaps, ACM transactions on Graphics, Vol. 22(2), [3] J. Cortés and T. Siméon, Probabilistic motion planning for parallel mechanisms, in Proc. IEEE International Conference on Robotics and Automation (ICRA 2003), [4] L. Han and N. Amato, A kinematics-based probabilistic roadmap method for closed chain systems, in Proceedings of International Workshop on Algorithmic Foundations of Robotics (WAFR 00), [5] L. Kavraki, P. Svestka, J.-C. Latombe, and M. Overmars, Probabilistic roadmaps for path planning in high-dimensional configuration spaces, in Proc. IEEE Transactions on Robotics and Automation, [6] Y. Koga, K. Kondo, J. Kuffner, and J. Latombe, Planning motions with intentions, ACM SIG- GRAPH Computer Graphics, vol. 28, pp , [12] J. Pettré, J.-P. Laumond, and T. Siméon, A 2-stages locomotion planner for digital actors, in Proc. ACM SIGGRAPH/Eurographics Symposium on Computer Animation. San Diego, California: Eurographics Association, 2003, pp [13] T. Siméon, J.-P. Laumond, and F. Lamiraux, Move3d: A generic platform for motion planning, in Proc. 4th International Symposium on Assembly and Task Planning (ISATP 2001), [14] T. Simeón, J.-P. Laumond, and C. Nissoux, Visibility based probabilistic roadmaps for motion planning, Advanced Robotics, vol. 14, no. 6, [15] D. Tolani, A. Goswami, and N. Badler, Realtime inverse kinematics techniques for antropomorphic limbs, Graphical models, no. 5, pp , [16] M. Unuma, K. Anjyo, and R. Takeuchi, Fourier principles for emotion-based human figure animation, in Proc. of SIGGRAPH 95, [17] A. Witkin and Z. Popovic, Motion warping, in Proc. of SIGGRAPH 95, [18] J. Zhao and N. Badler, Inverse kinematics positioning using nonlinear programming for highly articulated figures, ACM Transactions on Graphics, vol. 14, no. 4, [7] K. Kondo, Inverse kinematics of a human arm, Journal of Robotics and Systems, vol. 8, no. 2, pp , [8] J. Kuffner, Autonomous agents for real-time animation, Ph.D. dissertation, Stanford University, Stanford, CA, December 1999.

Planning Fine Motions for a Digital Factotum

Planning Fine Motions for a Digital Factotum Planning Fine Motions for a Digital Factotum Gustavo Arechavaleta Claudia Esteves LAAS-CNRS 7, avenue du Colonel Roche 31077, Toulouse Cedex, France {garechav, cesteves, jpl}@laas.fr Jean-Paul Laumond

More information

A 2-Stages Locomotion Planner for Digital Actors

A 2-Stages Locomotion Planner for Digital Actors A 2-Stages Locomotion Planner for Digital Actors Julien Pettré LAAS-CNRS 7, avenue du Colonel Roche 31077 Cedex 4 Toulouse, FRANCE Jean-Paul Laumond LAAS-CNRS 7, avenue du Colonel Roche 31077 Cedex 4 Toulouse,

More information

Etienne Ferré*, Jean-Paul Laumond**, Gustavo Arechavaleta**, Claudia Estevès**

Etienne Ferré*, Jean-Paul Laumond**, Gustavo Arechavaleta**, Claudia Estevès** International Conference on Product Lifecycle Management 1 Progresses in assembly path planning Etienne Ferré*, Jean-Paul Laumond**, Gustavo Arechavaleta**, Claudia Estevès** *KINEO C.A.M. Prologue, BP

More information

COORDINATED MOTION PLANNING FOR 3D ANIMATION USING CHINESE LION DANCE AS AN EXAMPLE. Fu-Sheng Yu and Tsai-Yen Li

COORDINATED MOTION PLANNING FOR 3D ANIMATION USING CHINESE LION DANCE AS AN EXAMPLE. Fu-Sheng Yu and Tsai-Yen Li Appear in Proceedings of International Workshop on Advanced Image Technology, Thailand, 2007. COORDINATED MOTION PLANNING FOR 3D ANIMATION USING CHINESE LION DANCE AS AN EXAMPLE Fu-Sheng Yu and Tsai-Yen

More information

Planning human walk in virtual environments

Planning human walk in virtual environments Planning human walk in virtual environments J. Pettré, T. Siméon, J.P. Laumond LAAS/CNRS, 7, avenue du Colonel Roche, 31077 Toulouse Cedex 04 - France {jpettre,nic,jpl}@laas.fr Abstract This paper presents

More information

Scalable Solutions for Interactive Virtual Humans that can Manipulate Objects

Scalable Solutions for Interactive Virtual Humans that can Manipulate Objects In Proceedings of the Artificial Intelligence and Interactive Digital Entertainment (AIIDE), Marina del Rey, CA, June 1-3, 2005, 69-74 Scalable Solutions for Interactive Virtual Humans that can Manipulate

More information

Real-time Reach Planning for Animated Characters Using Hardware Acceleration

Real-time Reach Planning for Animated Characters Using Hardware Acceleration Real-time Reach Planning for Animated Characters Using Hardware Acceleration Ying Liu Norman I. Badler Center for Human Modeling and Simulation Department of Computer and Information Science University

More information

Planning in Mobile Robotics

Planning in Mobile Robotics Planning in Mobile Robotics Part I. Miroslav Kulich Intelligent and Mobile Robotics Group Gerstner Laboratory for Intelligent Decision Making and Control Czech Technical University in Prague Tuesday 26/07/2011

More information

Geometric Path Planning McGill COMP 765 Oct 12 th, 2017

Geometric Path Planning McGill COMP 765 Oct 12 th, 2017 Geometric Path Planning McGill COMP 765 Oct 12 th, 2017 The Motion Planning Problem Intuition: Find a safe path/trajectory from start to goal More precisely: A path is a series of robot configurations

More information

A 12-DOF Analytic Inverse Kinematics Solver for Human Motion Control

A 12-DOF Analytic Inverse Kinematics Solver for Human Motion Control Journal of Information & Computational Science 1: 1 (2004) 137 141 Available at http://www.joics.com A 12-DOF Analytic Inverse Kinematics Solver for Human Motion Control Xiaomao Wu, Lizhuang Ma, Zhihua

More information

Coordinated Motion Planning for 3D Animation With Use of a Chinese Lion Dance as an Example

Coordinated Motion Planning for 3D Animation With Use of a Chinese Lion Dance as an Example Coordinated Motion Planning for 3D Animation With Use of a Chinese Lion Dance as an Example Fu-Sheng Yu and Tsai-Yen Li Computer Science Department, National Chengchi University, Taiwan, g9331@cs.nccu.edu.tw

More information

Planning with Reachable Distances: Fast Enforcement of Closure Constraints

Planning with Reachable Distances: Fast Enforcement of Closure Constraints Planning with Reachable Distances: Fast Enforcement of Closure Constraints Xinyu Tang Shawna Thomas Nancy M. Amato xinyut@cs.tamu.edu sthomas@cs.tamu.edu amato@cs.tamu.edu Technical Report TR6-8 Parasol

More information

8.7 Interactive Motion Correction and Object Manipulation

8.7 Interactive Motion Correction and Object Manipulation 8.7 Interactive Motion Correction and Object Manipulation 335 Interactive Motion Correction and Object Manipulation Ari Shapiro University of California, Los Angeles Marcelo Kallmann Computer Graphics

More information

A motion capture based control-space approach for walking mannequins

A motion capture based control-space approach for walking mannequins A motion capture based control-space approach for walking mannequins Julien PETTRE Jean-Paul LAUMOND LAAS-CNRS 7, avenue du Colonel Roche 31077 Toulouse, France +33 0) 561 33 63 47 {jpettre,jpl}@laas.fr

More information

Full-Body Behavioral Path Planning in Cluttered Environments

Full-Body Behavioral Path Planning in Cluttered Environments In Proceedings of the ACM SIGGRAPH Conference on Motion in Games (MIG), 2016. This is the manuscript of the authors. Full-Body Behavioral Path Planning in Cluttered Environments Alain Juarez-Perez University

More information

Coordinated Motion Planning for 3D Animation - With Use of a Chinese Lion Dance as an Example

Coordinated Motion Planning for 3D Animation - With Use of a Chinese Lion Dance as an Example 174 ECTI TRANSACTIONS ON ELECTRICAL ENG., ELECTRONICS, AND COMMUNICATIONS VOL.5, NO.2 August 2007 Coordinated Motion Planning for 3D Animation - With Use of a Chinese Lion Dance as an Example Fu-Sheng

More information

Workspace-Guided Rapidly-Exploring Random Tree Method for a Robot Arm

Workspace-Guided Rapidly-Exploring Random Tree Method for a Robot Arm WorkspaceGuided RapidlyExploring Random Tree Method for a Robot Arm Jaesik Choi choi31@cs.uiuc.edu August 12, 2007 Abstract Motion planning for robotic arms is important for real, physical world applications.

More information

Robot Motion Planning

Robot Motion Planning Robot Motion Planning James Bruce Computer Science Department Carnegie Mellon University April 7, 2004 Agent Planning An agent is a situated entity which can choose and execute actions within in an environment.

More information

Spring 2010: Lecture 9. Ashutosh Saxena. Ashutosh Saxena

Spring 2010: Lecture 9. Ashutosh Saxena. Ashutosh Saxena CS 4758/6758: Robot Learning Spring 2010: Lecture 9 Why planning and control? Video Typical Architecture Planning 0.1 Hz Control 50 Hz Does it apply to all robots and all scenarios? Previous Lecture: Potential

More information

Probabilistic roadmaps for efficient path planning

Probabilistic roadmaps for efficient path planning Probabilistic roadmaps for efficient path planning Dan A. Alcantara March 25, 2007 1 Introduction The problem of finding a collision-free path between points in space has applications across many different

More information

Humanoid Robotics. Inverse Kinematics and Whole-Body Motion Planning. Maren Bennewitz

Humanoid Robotics. Inverse Kinematics and Whole-Body Motion Planning. Maren Bennewitz Humanoid Robotics Inverse Kinematics and Whole-Body Motion Planning Maren Bennewitz 1 Motivation Planning for object manipulation Whole-body motion to reach a desired goal configuration Generate a sequence

More information

II. RELATED WORK. A. Probabilistic roadmap path planner

II. RELATED WORK. A. Probabilistic roadmap path planner Gaussian PRM Samplers for Dynamic Configuration Spaces Yu-Te Lin and Shih-Chia Cheng Computer Science Department Stanford University Stanford, CA 94305, USA {yutelin, sccheng}@cs.stanford.edu SUID: 05371954,

More information

Interval-Based Motion Blending for Hand Grasping

Interval-Based Motion Blending for Hand Grasping EG UK Theory and Practice of Computer Graphics (2007) Ik Soo Lim, David Duce (Editors) Interval-Based Motion Blending for Hand Grasping Matt Brisbin and Bedřich Beneš Purdue University {mbrisbin bbenes}@purdue.edu

More information

Dexterous Manipulation Planning Using Probabilistic Roadmaps in Continuous Grasp Subspaces

Dexterous Manipulation Planning Using Probabilistic Roadmaps in Continuous Grasp Subspaces Dexterous Manipulation Planning Using Probabilistic Roadmaps in Continuous Grasp Subspaces Jean-Philippe Saut, Anis Sahbani, Sahar El-Khoury and Véronique Perdereau Université Pierre et Marie Curie-Paris6,

More information

10/25/2018. Robotics and automation. Dr. Ibrahim Al-Naimi. Chapter two. Introduction To Robot Manipulators

10/25/2018. Robotics and automation. Dr. Ibrahim Al-Naimi. Chapter two. Introduction To Robot Manipulators Robotics and automation Dr. Ibrahim Al-Naimi Chapter two Introduction To Robot Manipulators 1 Robotic Industrial Manipulators A robot manipulator is an electronically controlled mechanism, consisting of

More information

Humanoid Robotics. Inverse Kinematics and Whole-Body Motion Planning. Maren Bennewitz

Humanoid Robotics. Inverse Kinematics and Whole-Body Motion Planning. Maren Bennewitz Humanoid Robotics Inverse Kinematics and Whole-Body Motion Planning Maren Bennewitz 1 Motivation Plan a sequence of configurations (vector of joint angle values) that let the robot move from its current

More information

Path Planning for a Robot Manipulator based on Probabilistic Roadmap and Reinforcement Learning

Path Planning for a Robot Manipulator based on Probabilistic Roadmap and Reinforcement Learning 674 International Journal Jung-Jun of Control, Park, Automation, Ji-Hun Kim, and and Systems, Jae-Bok vol. Song 5, no. 6, pp. 674-680, December 2007 Path Planning for a Robot Manipulator based on Probabilistic

More information

Inverse Kinematics Analysis for Manipulator Robot With Wrist Offset Based On the Closed-Form Algorithm

Inverse Kinematics Analysis for Manipulator Robot With Wrist Offset Based On the Closed-Form Algorithm Inverse Kinematics Analysis for Manipulator Robot With Wrist Offset Based On the Closed-Form Algorithm Mohammed Z. Al-Faiz,MIEEE Computer Engineering Dept. Nahrain University Baghdad, Iraq Mohammed S.Saleh

More information

Figure 1: A typical industrial scene with over 4000 obstacles. not cause collisions) into a number of cells. Motion is than planned through these cell

Figure 1: A typical industrial scene with over 4000 obstacles. not cause collisions) into a number of cells. Motion is than planned through these cell Recent Developments in Motion Planning Λ Mark H. Overmars Institute of Information and Computing Sciences, Utrecht University, P.O. Box 80.089, 3508 TB Utrecht, the Netherlands. Email: markov@cs.uu.nl.

More information

Kinodynamic Motion Planning on Roadmaps in Dynamic Environments

Kinodynamic Motion Planning on Roadmaps in Dynamic Environments Proceedings of the 2007 IEEE/RSJ International Conference on Intelligent Robots and Systems San Diego, CA, USA, Oct 29 - Nov 2, 2007 ThD11.1 Kinodynamic Motion Planning on Roadmaps in Dynamic Environments

More information

Adaptive Tuning of the Sampling Domain for Dynamic-Domain RRTs

Adaptive Tuning of the Sampling Domain for Dynamic-Domain RRTs Adaptive Tuning of the Sampling Domain for Dynamic-Domain RRTs Léonard Jaillet Anna Yershova LAAS-CNRS 7, Avenue du Colonel Roche 31077 Toulouse Cedex 04,France {ljaillet, nic}@laas.fr Steven M. LaValle

More information

Motion Planning with Dynamics, Physics based Simulations, and Linear Temporal Objectives. Erion Plaku

Motion Planning with Dynamics, Physics based Simulations, and Linear Temporal Objectives. Erion Plaku Motion Planning with Dynamics, Physics based Simulations, and Linear Temporal Objectives Erion Plaku Laboratory for Computational Sensing and Robotics Johns Hopkins University Frontiers of Planning The

More information

Mobile Robot Path Planning in Static Environments using Particle Swarm Optimization

Mobile Robot Path Planning in Static Environments using Particle Swarm Optimization Mobile Robot Path Planning in Static Environments using Particle Swarm Optimization M. Shahab Alam, M. Usman Rafique, and M. Umer Khan Abstract Motion planning is a key element of robotics since it empowers

More information

Geometric Path Planning for General Robot Manipulators

Geometric Path Planning for General Robot Manipulators Proceedings of the World Congress on Engineering and Computer Science 29 Vol II WCECS 29, October 2-22, 29, San Francisco, USA Geometric Path Planning for General Robot Manipulators Ziyad Aljarboua Abstract

More information

MCE/EEC 647/747: Robot Dynamics and Control. Lecture 1: Introduction

MCE/EEC 647/747: Robot Dynamics and Control. Lecture 1: Introduction MCE/EEC 647/747: Robot Dynamics and Control Lecture 1: Introduction Reading: SHV Chapter 1 Robotics and Automation Handbook, Chapter 1 Assigned readings from several articles. Cleveland State University

More information

Efficient Planning of Spatially Constrained Robot Using Reachable Distances

Efficient Planning of Spatially Constrained Robot Using Reachable Distances Efficient Planning of Spatially Constrained Robot Using Reachable Distances Xinyu Tang Shawna Thomas Nancy M. Amato xinyut@cs.tamu.edu sthomas@cs.tamu.edu amato@cs.tamu.edu Technical Report TR07-001 Parasol

More information

Path Deformation Roadmaps

Path Deformation Roadmaps Path Deformation Roadmaps Léonard Jaillet and Thierry Siméon LAAS-CNRS, Toulouse, France, {ljaillet,nic}@laas.fr Abstract: This paper describes a new approach to sampling-based motion planning with PRM

More information

A motion capture-based control-space approach for walking mannequins

A motion capture-based control-space approach for walking mannequins 0 0 0 COMPUTER ANIMATION AND VIRTUAL WORLDS Comp. Anim. Virtual Worlds 0; : Published online in Wiley InterScience (www.interscience.wiley.com). DOI:.0/cav.0 A motion capture-based control-space approach

More information

Robotics Tasks. CS 188: Artificial Intelligence Spring Manipulator Robots. Mobile Robots. Degrees of Freedom. Sensors and Effectors

Robotics Tasks. CS 188: Artificial Intelligence Spring Manipulator Robots. Mobile Robots. Degrees of Freedom. Sensors and Effectors CS 188: Artificial Intelligence Spring 2006 Lecture 5: Robot Motion Planning 1/31/2006 Dan Klein UC Berkeley Many slides from either Stuart Russell or Andrew Moore Motion planning (today) How to move from

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

vizmo++: a Visualization, Authoring, and Educational Tool for Motion Planning

vizmo++: a Visualization, Authoring, and Educational Tool for Motion Planning vizmo++: a Visualization, Authoring, and Educational Tool for Motion Planning Aimée Vargas E. Jyh-Ming Lien Nancy M. Amato. aimee@cs.tamu.edu neilien@cs.tamu.edu amato@cs.tamu.edu Technical Report TR05-011

More information

Robot Motion Planning

Robot Motion Planning Robot Motion Planning slides by Jan Faigl Department of Computer Science and Engineering Faculty of Electrical Engineering, Czech Technical University in Prague lecture A4M36PAH - Planning and Games Dpt.

More information

Motion Planning of Human-Like Robots using Constrained Coordination

Motion Planning of Human-Like Robots using Constrained Coordination Motion Planning of Human-Like Robots using Constrained Coordination Liangjun Zhang Jia Pan Dinesh Manocha {zlj,panj,dm}@cs.unc.edu Dept. of Computer Science, University of North Carolina at Chapel Hill

More information

Dynamic-Domain RRTs: Efficient Exploration by Controlling the Sampling Domain

Dynamic-Domain RRTs: Efficient Exploration by Controlling the Sampling Domain Dynamic-Domain RRTs: Efficient Exploration by Controlling the Sampling Domain Anna Yershova Léonard Jaillet Department of Computer Science University of Illinois Urbana, IL 61801 USA {yershova, lavalle}@uiuc.edu

More information

Probabilistic Motion Planning: Algorithms and Applications

Probabilistic Motion Planning: Algorithms and Applications Probabilistic Motion Planning: Algorithms and Applications Jyh-Ming Lien Department of Computer Science George Mason University Motion Planning in continuous spaces (Basic) Motion Planning (in a nutshell):

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

Advanced Robotics Path Planning & Navigation

Advanced Robotics Path Planning & Navigation Advanced Robotics Path Planning & Navigation 1 Agenda Motivation Basic Definitions Configuration Space Global Planning Local Planning Obstacle Avoidance ROS Navigation Stack 2 Literature Choset, Lynch,

More information

Motion Planning for Humanoid Walking in a Layered Environment

Motion Planning for Humanoid Walking in a Layered Environment Appear in Proceedings of the IEEE International Conference on Robotics and Automation (ICRA), 2003 Motion Planning for Humanoid Walking in a Layered Environment Tsai-Yen Li Computer Science Department

More information

Search Spaces I. Before we get started... ME/CS 132b Advanced Robotics: Navigation and Perception 4/05/2011

Search Spaces I. Before we get started... ME/CS 132b Advanced Robotics: Navigation and Perception 4/05/2011 Search Spaces I b Advanced Robotics: Navigation and Perception 4/05/2011 1 Before we get started... Website updated with Spring quarter grading policy 30% homework, 20% lab, 50% course project Website

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

Principles of Robot Motion

Principles of Robot Motion Principles of Robot Motion Theory, Algorithms, and Implementation Howie Choset, Kevin Lynch, Seth Hutchinson, George Kantor, Wolfram Burgard, Lydia Kavraki, and Sebastian Thrun A Bradford Book The MIT

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

Kinematics: Intro. Kinematics is study of motion

Kinematics: Intro. Kinematics is study of motion Kinematics is study of motion Kinematics: Intro Concerned with mechanisms and how they transfer and transform motion Mechanisms can be machines, skeletons, etc. Important for CG since need to animate complex

More information

Character Animation Seminar Report: Complementing Physics with Motion Capture

Character Animation Seminar Report: Complementing Physics with Motion Capture Character Animation Seminar Report: Complementing Physics with Motion Capture Stefan John 1, and Alexis Heloir 2 1 Saarland University, Computer Graphics Lab, Im Stadtwald Campus E 1 1, 66123 Saarbrücken,

More information

Learning Humanoid Reaching Tasks in Dynamic Environments

Learning Humanoid Reaching Tasks in Dynamic Environments Proceedings of the 2007 IEEE/RSJ International Conference on Intelligent Robots and Systems San Diego, CA, USA, Oct 29 - Nov 2, 2007 TuD3.5 Learning Humanoid Reaching Tasks in Dynamic Environments Xiaoxi

More information

Introduction to State-of-the-art Motion Planning Algorithms. Presented by Konstantinos Tsianos

Introduction to State-of-the-art Motion Planning Algorithms. Presented by Konstantinos Tsianos Introduction to State-of-the-art Motion Planning Algorithms Presented by Konstantinos Tsianos Robots need to move! Motion Robot motion must be continuous Geometric constraints Dynamic constraints Safety

More information

animation projects in digital art animation 2009 fabio pellacini 1

animation projects in digital art animation 2009 fabio pellacini 1 animation projects in digital art animation 2009 fabio pellacini 1 animation shape specification as a function of time projects in digital art animation 2009 fabio pellacini 2 how animation works? flip

More information

6.141: Robotics systems and science Lecture 9: Configuration Space and Motion Planning

6.141: Robotics systems and science Lecture 9: Configuration Space and Motion Planning 6.141: Robotics systems and science Lecture 9: Configuration Space and Motion Planning Lecture Notes Prepared by Daniela Rus EECS/MIT Spring 2012 Figures by Nancy Amato, Rodney Brooks, Vijay Kumar Reading:

More information

Motion Planning with interactive devices

Motion Planning with interactive devices Motion Planning with interactive devices Michel Taïx CNRS; LAAS ; 7, av. du Colonel Roche, 31077 Toulouse, France, Université de Toulouse; UPS, INSA, INP, ISAE ; LAAS ; F-31077 Toulouse, France Email:

More information

Configuration Space of a Robot

Configuration Space of a Robot Robot Path Planning Overview: 1. Visibility Graphs 2. Voronoi Graphs 3. Potential Fields 4. Sampling-Based Planners PRM: Probabilistic Roadmap Methods RRTs: Rapidly-exploring Random Trees Configuration

More information

Nonholonomic motion planning for car-like robots

Nonholonomic motion planning for car-like robots Nonholonomic motion planning for car-like robots A. Sánchez L. 2, J. Abraham Arenas B. 1, and René Zapata. 2 1 Computer Science Dept., BUAP Puebla, Pue., México {aarenas}@cs.buap.mx 2 LIRMM, UMR5506 CNRS,

More information

Human Character Animation in 3D-Graphics: The EMOTE System as a Plug-in for Maya

Human Character Animation in 3D-Graphics: The EMOTE System as a Plug-in for Maya Hartmann - 1 Bjoern Hartman Advisor: Dr. Norm Badler Applied Senior Design Project - Final Report Human Character Animation in 3D-Graphics: The EMOTE System as a Plug-in for Maya Introduction Realistic

More information

Algorithms for Sensor-Based Robotics: Sampling-Based Motion Planning

Algorithms for Sensor-Based Robotics: Sampling-Based Motion Planning Algorithms for Sensor-Based Robotics: Sampling-Based Motion Planning Computer Science 336 http://www.cs.jhu.edu/~hager/teaching/cs336 Professor Hager http://www.cs.jhu.edu/~hager Recall Earlier Methods

More information

Design and Implementation of Synthetic Humans for Virtual Environments and Simulation Systems

Design and Implementation of Synthetic Humans for Virtual Environments and Simulation Systems Design and Implementation of Synthetic Humans for Virtual Environments and Simulation Systems SPYROS VOSINAKIS, THEMIS PANAYIOTOPOULOS Department of Informatics University of Piraeus 80 Karaoli & Dimitriou

More information

Hierarchical Optimization-based Planning for High-DOF Robots

Hierarchical Optimization-based Planning for High-DOF Robots Hierarchical Optimization-based Planning for High-DOF Robots Chonhyon Park and Jia Pan and Dinesh Manocha Abstract We present an optimization-based motion planning algorithm for high degree-of-freedom

More information

Specialized PRM Trajectory Planning For Hyper-Redundant Robot Manipulators

Specialized PRM Trajectory Planning For Hyper-Redundant Robot Manipulators Specialized PRM Trajectory Planning For Hyper-Redundant Robot Manipulators MAHDI F. GHAJARI and RENE V. MAYORGA Department of Industrial Systems Engineering University of Regina 3737 Wascana Parkway, Regina,

More information

D-Plan: Efficient Collision-Free Path Computation for Part Removal and Disassembly

D-Plan: Efficient Collision-Free Path Computation for Part Removal and Disassembly 774 Computer-Aided Design and Applications 2008 CAD Solutions, LLC http://www.cadanda.com D-Plan: Efficient Collision-Free Path Computation for Part Removal and Disassembly Liangjun Zhang 1, Xin Huang

More information

Planning Collision-Free Reaching Motions for Interactive Object Manipulation and Grasping

Planning Collision-Free Reaching Motions for Interactive Object Manipulation and Grasping EUROGRAPHICS 2003 / P. Brunet and D. Fellner (Guest Editors) Volume 22 (2003), Number 3 Planning Collision-Free Reaching Motions for Interactive Object Manipulation and Grasping Marcelo Kallmann, 1 Amaury

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

Configuration Space. Ioannis Rekleitis

Configuration Space. Ioannis Rekleitis Configuration Space Ioannis Rekleitis Configuration Space Configuration Space Definition A robot configuration is a specification of the positions of all robot points relative to a fixed coordinate system

More information

Trajectory Optimization

Trajectory Optimization Trajectory Optimization Jane Li Assistant Professor Mechanical Engineering & Robotics Engineering http://users.wpi.edu/~zli11 Recap We heard about RRT*, a sampling-based planning in high-dimensional cost

More information

Variable-resolution Velocity Roadmap Generation Considering Safety Constraints for Mobile Robots

Variable-resolution Velocity Roadmap Generation Considering Safety Constraints for Mobile Robots Variable-resolution Velocity Roadmap Generation Considering Safety Constraints for Mobile Robots Jingyu Xiang, Yuichi Tazaki, Tatsuya Suzuki and B. Levedahl Abstract This research develops a new roadmap

More information

This week. CENG 732 Computer Animation. Warping an Object. Warping an Object. 2D Grid Deformation. Warping an Object.

This week. CENG 732 Computer Animation. Warping an Object. Warping an Object. 2D Grid Deformation. Warping an Object. CENG 732 Computer Animation Spring 2006-2007 Week 4 Shape Deformation Animating Articulated Structures: Forward Kinematics/Inverse Kinematics This week Shape Deformation FFD: Free Form Deformation Hierarchical

More information

Path Planning with Motion Optimization for Car Body-In-White Industrial Robot Applications

Path Planning with Motion Optimization for Car Body-In-White Industrial Robot Applications Advanced Materials Research Online: 2012-12-13 ISSN: 1662-8985, Vols. 605-607, pp 1595-1599 doi:10.4028/www.scientific.net/amr.605-607.1595 2013 Trans Tech Publications, Switzerland Path Planning with

More information

Manipulator trajectory planning

Manipulator trajectory planning Manipulator trajectory planning Václav Hlaváč Czech Technical University in Prague Faculty of Electrical Engineering Department of Cybernetics Czech Republic http://cmp.felk.cvut.cz/~hlavac Courtesy to

More information

crrt : Planning loosely-coupled motions for multiple mobile robots

crrt : Planning loosely-coupled motions for multiple mobile robots crrt : Planning loosely-coupled motions for multiple mobile robots Jan Rosell and Raúl Suárez Institute of Industrial and Control Engineering (IOC) Universitat Politècnica de Catalunya (UPC) Barcelona

More information

Motion Synthesis and Editing. Yisheng Chen

Motion Synthesis and Editing. Yisheng Chen Motion Synthesis and Editing Yisheng Chen Overview Data driven motion synthesis automatically generate motion from a motion capture database, offline or interactive User inputs Large, high-dimensional

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

Motion Control with Strokes

Motion Control with Strokes Motion Control with Strokes Masaki Oshita Kyushu Institute of Technology oshita@ces.kyutech.ac.jp Figure 1: Examples of stroke-based motion control. Input strokes (above) and generated motions (below).

More information

Small-Space Controllability of a Walking Humanoid Robot

Small-Space Controllability of a Walking Humanoid Robot Small-Space Controllability of a Walking Humanoid Robot Se bastien Dalibard, Antonio El Khoury, Florent Lamiraux, Michel Taı x, Jean-Paul Laumond hal-00602384, version 2-19 Sep 2011 CNRS ; LAAS ; 7 avenue

More information

Local Search Methods. CS 188: Artificial Intelligence Fall Announcements. Hill Climbing. Hill Climbing Diagram. Today

Local Search Methods. CS 188: Artificial Intelligence Fall Announcements. Hill Climbing. Hill Climbing Diagram. Today CS 188: Artificial Intelligence Fall 2006 Lecture 5: Robot Motion Planning 9/14/2006 Local Search Methods Queue-based algorithms keep fallback options (backtracking) Local search: improve what you have

More information

Ballistic motion planning for jumping superheroes

Ballistic motion planning for jumping superheroes Ballistic motion planning for jumping superheroes Myle ne Campana, Pierre Fernbach, Steve Tonneau, Michel Taı x, Jean-Paul Laumond Figure 1: Sequences of jumps computed by our planner in three environments.

More information

Embedding a Motion-Capture Interface in a Control Structure for Human Like Agent Behavior Achievement

Embedding a Motion-Capture Interface in a Control Structure for Human Like Agent Behavior Achievement Embedding a Motion-Capture Interface in a Control Structure for Human Like Agent Behavior Achievement LUIZ GARCIA 1 FERNANDO DA SILVA 2 3 ANTONIO OLIVEIRA 2 LUIZ VELHO 3 JONAS GOMES 3 1 Laboratoire d Analyse

More information

CHAPTER SIX. the RRM creates small covering roadmaps for all tested environments.

CHAPTER SIX. the RRM creates small covering roadmaps for all tested environments. CHAPTER SIX CREATING SMALL ROADMAPS Many algorithms have been proposed that create a roadmap from which a path for a moving object can be extracted. These algorithms generally do not give guarantees on

More information

SPATIAL GUIDANCE TO RRT PLANNER USING CELL-DECOMPOSITION ALGORITHM

SPATIAL GUIDANCE TO RRT PLANNER USING CELL-DECOMPOSITION ALGORITHM SPATIAL GUIDANCE TO RRT PLANNER USING CELL-DECOMPOSITION ALGORITHM Ahmad Abbadi, Radomil Matousek, Pavel Osmera, Lukas Knispel Brno University of Technology Institute of Automation and Computer Science

More information

arxiv: v2 [cs.ro] 29 Jul 2016

arxiv: v2 [cs.ro] 29 Jul 2016 Scaling Sampling based Motion Planning to Humanoid Robots Yiming Yang, Vladimir Ivan, Wolfgang Merkt, Sethu Vijayakumar arxiv:1607.07470v2 [cs.ro] 29 Jul 2016 Abstract Planning balanced and collision free

More information

CS 4649/7649 Robot Intelligence: Planning

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

More information

Saving Time for Object Finding with a Mobile Manipulator Robot in 3D Environment

Saving Time for Object Finding with a Mobile Manipulator Robot in 3D Environment Saving Time for Object Finding with a Mobile Manipulator Robot in 3D Environment Centro de Investigación en Matemáticas, CIMAT, Guanajuato, Mexico jespinoza@cimat.mx, murrieta@cimat.mx Abstract. In this

More information

KINEMATICS FOR ANIMATION. Rémi Ronfard, Animation, M2R MOSIG

KINEMATICS FOR ANIMATION. Rémi Ronfard, Animation, M2R MOSIG KINEMATICS FOR ANIMATION Rémi Ronfard, Animation, M2R MOSIG Direct and inverse kinematics in animation Fast numerical methods for inverse kinematics by Bill Baxter My Adventures with Inverse Kinematics

More information

Algorithmic Robotics and Motion Planning

Algorithmic Robotics and Motion Planning Algorithmic Robotics and Motion Planning Spring 2018 Introduction Dan Halperin School of Computer Science Tel Aviv University Dolce & Gabbana 2018 handbag collection Today s lesson basic terminology fundamental

More information

Kinematics, Kinematics Chains CS 685

Kinematics, Kinematics Chains CS 685 Kinematics, Kinematics Chains CS 685 Previously Representation of rigid body motion Two different interpretations - as transformations between different coord. frames - as operators acting on a rigid body

More information

Efficient Motion Planning for Humanoid Robots using Lazy Collision Checking and Enlarged Robot Models

Efficient Motion Planning for Humanoid Robots using Lazy Collision Checking and Enlarged Robot Models Efficient Motion Planning for Humanoid Robots using Lazy Collision Checking and Enlarged Robot Models Nikolaus Vahrenkamp, Tamim Asfour and Rüdiger Dillmann Institute of Computer Science and Engineering

More information

INCREASING THE CONNECTIVITY OF PROBABILISTIC ROADMAPS VIA GENETIC POST-PROCESSING. Giuseppe Oriolo Stefano Panzieri Andrea Turli

INCREASING THE CONNECTIVITY OF PROBABILISTIC ROADMAPS VIA GENETIC POST-PROCESSING. Giuseppe Oriolo Stefano Panzieri Andrea Turli INCREASING THE CONNECTIVITY OF PROBABILISTIC ROADMAPS VIA GENETIC POST-PROCESSING Giuseppe Oriolo Stefano Panzieri Andrea Turli Dip. di Informatica e Sistemistica, Università di Roma La Sapienza, Via Eudossiana

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

Multi-Modal Motion Planning for a Humanoid Robot Manipulation Task

Multi-Modal Motion Planning for a Humanoid Robot Manipulation Task Multi-Modal Motion Planning for a Humanoid Robot Manipulation Task Kris Hauser 1, Victor Ng-Thow-Hing 2, and Hector Gonzalez-Baños 2 1 Computer Science Department, Stanford University, Stanford, CA USA

More information

Computer Animation. Algorithms and Techniques. z< MORGAN KAUFMANN PUBLISHERS. Rick Parent Ohio State University AN IMPRINT OF ELSEVIER SCIENCE

Computer Animation. Algorithms and Techniques. z< MORGAN KAUFMANN PUBLISHERS. Rick Parent Ohio State University AN IMPRINT OF ELSEVIER SCIENCE Computer Animation Algorithms and Techniques Rick Parent Ohio State University z< MORGAN KAUFMANN PUBLISHERS AN IMPRINT OF ELSEVIER SCIENCE AMSTERDAM BOSTON LONDON NEW YORK OXFORD PARIS SAN DIEGO SAN FRANCISCO

More information

Optimal motion trajectories. Physically based motion transformation. Realistic character animation with control. Highly dynamic motion

Optimal motion trajectories. Physically based motion transformation. Realistic character animation with control. Highly dynamic motion Realistic character animation with control Optimal motion trajectories Physically based motion transformation, Popovi! and Witkin Synthesis of complex dynamic character motion from simple animation, Liu

More information

Announcements. CS 188: Artificial Intelligence Fall Robot motion planning! Today. Robotics Tasks. Mobile Robots

Announcements. CS 188: Artificial Intelligence Fall Robot motion planning! Today. Robotics Tasks. Mobile Robots CS 188: Artificial Intelligence Fall 2007 Lecture 6: Robot Motion Planning 9/13/2007 Announcements Project 1 due (yesterday)! Project 2 (Pacman with ghosts) up in a few days Reminder: you are allowed to

More information

CS 188: Artificial Intelligence Fall Announcements

CS 188: Artificial Intelligence Fall Announcements CS 188: Artificial Intelligence Fall 2007 Lecture 6: Robot Motion Planning 9/13/2007 Dan Klein UC Berkeley Many slides over the course adapted from either Stuart Russell or Andrew Moore Announcements Project

More information

Factor-Guided Motion Planning for a Robot Arm

Factor-Guided Motion Planning for a Robot Arm Factor-Guided Motion Planning for a Robot Arm Jaesik Choi and Eyal Amir Computer Science Department University of Illinois at Urbana-Champaign Urbana, IL 61801 {choi31,eyal}@cs.uiuc.edu Abstract Motion

More information