Real-Time Multi-Body Vehicle Dynamics Using A Modular Modeling Methodology

Size: px
Start display at page:

Download "Real-Time Multi-Body Vehicle Dynamics Using A Modular Modeling Methodology"

Transcription

1 Real-Time Multi-ody Vehicle Dynamics Using Modular Modeling Methodology Copyright 2003 Society o utomotive Engineers, nc. Richard Romano Realtime Technologies, nc. STRCT Simulations o ground vehicles are extensively used by military and commercial vehicle developers to aid in the design process. n the past, ground vehicle simulations have ocused on non-real-time models. However with the advancement o computers and modeling methodologies, real-time multi-body models have become one o the standard tools used by vehicle developers. Multi-body models are composed o joint, body, and orce elements which map well into a modular modeling approach. ased on recursive techniques a set o reusable components were developed or use in a graphical simulation and modeling environment. The components were then connected to orm a real-time multi-body model o a Ford Taurus. Finally, the Taurus model was integrated with simulator cueing subsystems to build a complete driving simulator. The perormance o the Taurus model was compared with test data. t was ound that the vehicle model was both accurate and ran much aster than real-time. Due to the model ormulation, the current set o modular components are limited to modeling open treed systems with either a ixed or mobile base body. 1. multi-body system consists o rigid bodies and ideal joints. body may degenerate to a particle or to a body without inertia. 2. The topology o the multi-body system is arbitrary. Chains, trees and closed loops are admitted. 3. odies, joints and actuators are summarized in libraries o standard elements. Kecskemethy [2] developed a ormalization o representing multi-body elements using a modular datalow representation. Figure 1 shows a Rigid Link and Joint. n the igure, q is the position vector o the rame. The derivatives o q contain the velocities and accelerations o the rame. Q represents the generalized orces in each coordinate rame. The generalized orces are made up o both inertial orces and external orces and are generated by mass, spring, damper, or active elements as given in Figure 2. NTRODUCTON Over the past twenty years oline vehicle dynamics simulations have been used extensively in the automotive industry. s computer perormance increased vehicle dynamics applications were introduced into hardware in the loop simulation and operator in the loop simulation laboratories. To meet the needs o vehicle designers the complexity and idelity o the vehicle dynamics used in operator in the loop simulation has been increasing and typically multi-body dynamics are used in this environment. Multi-body dynamics is based on classical mechanics. The multi-body method utilizes a inite set o elements including rigid bodies, joints, springs, dampers, and actuators. n the irst steps o standardization o a datamodel o multi-body systems or use with computer codes, the ollowing assumptions have been agreed upon [1]: Figure 1: Rigid Link and Joint (rom Krebs [3]) Figure 2: Mass Element and Spring (rom Krebs [3]) Each element provides a unction mapping the position q rom the current rame to the next rame. The mapping unctions are typically straight orward.

2 Kecskemethy [2] and Craig [4] give good descriptions o mapping unctions or revolute and prismatic joints. n the case o a joint, the unction takes into account the joint position, velocity and acceleration. s given by Krebs [3], the position q and its derivatives in Frame can be calculated rom Frame as: q q& q&& = ( q ) = J = J q& q&& + J& q& and the generalized orces o Frame can be calculated rom Frame as: where: Q is the Jacobian matrix. J = J T = q Q The approach used in this paper is to develop a set o sotware components that represent links, joints, bodies, and actuators as deined in Figure 1 and 2. y calling the sotware components in a particular order a multibody structure can be developed as a set o link, joint, mass, and orce elements. y calculating inside each joint sotware component a joint torque τ as the dot product between the generalized orce Q acting on the joint and the joint axis, the set o joint torques required to generate a particular mechanism acceleration, position and velocity can be determined. The resulting sotware structure solves the inverse dynamics problem: what joint torques are required to yield a particular set o positions, velocities, and accelerations o a mechanism. ntroducing a set o generalized coordinates: Θ, that represent joint angles and position, in general the set o joint torques τ required will take the ollowing orm: τ = M ( Θ) Θ && + V ( Θ, Θ& ) + G( Θ) where M is deined as the mass matrix, V represents centriugal and coriolis eects, and G represents gravity eects. With a set o sotware that computationally solves the inverse dynamics problem, the diiculty is solving the orward dynamics problem. That is given a set o joint torques what is the resulting motion o the actuator. Walker and Orin [5] developed several methods o solving or the joint accelerations Θ & given a set o joint torques. Once the joint accelerations are known the joint velocities and positions can be calculated using numerical integration techniques. The method used in this paper is similar to Method 3 in [5]. For a particular time step the method can be described as ollows: 1. Using the joint positions and velocities rom the previous step calculate a torque bias vector b that is the torque at each joint required or zero joint acceleration: b = V ( Θ, Θ& ) + G( Θ). 2. With the joint velocities and gravity set to zero (i.e. with the torque bias vector set to zero), calculate the joint torque vector or a unit joint acceleration or each joint separately (i.e. all other joint accelerations set to zero). The joint torques calculated are essentially a column o the mass matrix. Once all the columns o the mass matrix have been computed, and given the actual torques acting at each joint, the acceleration o the joints can be calculated as: 1 Θ & = M ( Θ)( τ b) The joint accelerations can then be integrated to yield the joint positions and velocities or the next step. MPLEMENTTON The links, joints, bodies, and actuators were developed and assembled as modular components in SimCreator a graphical simulation tool rom Realtime Technologies, nc. The link or oset component and a revolute mechanism are shown in Figure 3. Linccel1 LinVel1 LinPos1 ngccel1 ngvel1 TM1 Force1 Moment1 LinkNumber1 Linccel1 LinVel1 LinPos1 ngccel1 ngvel1 TM1 Force1 Moment1 LinkNumber1 Oset OsetM LocalJointxis Revolute Figure 3: SimCreator ased Link and Joint Linccel3 LinVel3 LinPos3 ngccel3 ngvel3 TM3 Force3 Moment3 LinkNumber3 Linccel3 LinVel3 LinPos3 ngccel3 ngvel3 TM3 Force3 Moment3 LinkNumber3 Jointng JointngRate ExternalJointTorque

3 n the SimCreator components in Figure 3, the data passed downstream are the linear acceleration, velocity and position o the rame (LinPos1, LinVel1, Linccel1), and the angular acceleration, velocity and transormation matrix o the rame (ngccel1, ngvel1, TM1). The generalized orces are passed back upstream in Force1 and Moment1. Finally a set o link numbers are passed downstream. These itemized the set o joints that are upstream o the current component. n this way joint orces and accelerations can be associated with the correct set o joints. The velocity and position vectors (LinVel1, LinPos1, and ngvel1) are each o length three, containing the component values or three dimensions. The acceleration vectors, orces and moments are each a 3xN matrix. Each index across the acceleration matrix represents the acceleration in the rame due to a unit acceleration o a particular joint. Each index across the orces and moments matrices represents the generalized orces due to a unit acceleration o a particular joint. These matrices are used to calculate the columns o the mass matrix. Due to the model ormulation, the current set o modular components are limited to modeling open treed systems with either a ixed or mobile base body. VLDTON model is shown in Figure 8. The powertrain, shown in Figure 7, and other subsystems were modeled in a similar ashion to previous vehicle models developed using SimCreator [8]. Figure 5: DDS Position o Second Pendulum (rom Hwang [6]) 4 double pendulum was modeled using the developed components. This is shown in Figure 4. OsetM1 RevoluteJoint1 OsetM RevoluteJoint ydot o the second pendulum (m/s) Gain Sum Gain2 Sum Time (seconds) Figure 6: SimCreator Position o Second Pendulum Gain1 Gain3 Figure 4: Double Pendulum The double pendulum was conigured to have the same geometry as Hwang [6]. Hwang perormed a dynamic analysis o a double pendulum using DDS and two other multi-body dynamics packages. The result o their DDS model is given in Figure 5. The results o the SimCreator model are given in Figure 6. Comparison o the results o several plots generated in SimCreator showed excellent agreement with Hwang. SumFR SumFL FRWheel FrontDi rakes COMPONENT SumRL SumRR RRWheel VEHCLE MODEL vehicle dynamics model was developed similar to Sayers [7]. The vehicle was modeled with a base body with six degrees o reedom and our prismatic joints representing each o the corners o the vehicle. The prismatic joints were tilted to take into account anti-dive, anti-squat geometry and roll center height. The vehicle FLWheel TorqueConverter Engine Figure 4: Front Wheel Drive Powertrain Gearox RLWheel

4 cksteer COMPONENT PowerTrain FRCorner OsetFR Simpero erooset OsetRR RRCorner CornerForces SixDOFody FLCorner OsetFL OsetRL RLCorner Figure 8: Complete Vehicle Dynamics SimCreator components shown in Figure 8 are as ollows: PowerTrain calculates all powertrain and brake system eects and outputs the our wheel speeds o the vehicle, Simpero calculates the aerodynamic orces on the vehicle, SixDOFody is the base body o the multi-body dynamics model, Oset calculates the position, velocity and acceleration at an oset and translates the generalized orces at the oset back to the center o gravity, CornerForces sums up the generalized orces o the multi-body tree structure, Corner calculates the independent suspension and the tire model at a vehicle corner, and outputs the orces acting at the corner and the torque acting on the wheel. The Corner module contains inside it the prismatic joint as well as a tire model. ForcesMergeMForce properties, osets, suspension and tire characteristics, and powertrain inormation. n addition to parameters, Salaani collected test data rom an actual vehicle. The test data was used to validate the Ford Taurus model. Figures 9 and 10 show the roll response o the model to a lateral handling maneuver using a smooth low rate steering input at 32 m/s. The dotted line in Figure 9 represents test data. The results match up well with the roll angles predicted by the SimCreator model in Figure 10. variety o maneuvers and responses were tested and compared with Salaani [10]. Results were ound to be reasonably accurate given that all o the vehicle parameters and all the test inputs (steering wheel, accelerator and brake orce) were not available Roll ngle (deg) Figure 9: Lateral Response o Ford Taurus (rom Salaani [10]) Lateral cceleration (m/s/s) Figure 10: Lateral Response o SimCreator Model The vehicle dynamics model was conigured to represent a Ford Taurus using parameters collected by Salaani et al [9][10][11]. The Ford Taurus vehicle parameters collected by Salaani included mass DRVNG SMULTOR The multi-body vehicle dynamics were inserted into a driving simulator to test its use in an operator in the loop

5 environment. typical driving simulator has the ollowing cueing systems: audio, out the window graphics, driving control interace, and motion. These can be encapsulated as modules and integrated with the vehicle dynamics to orm the driving simulator shown in Figure 11. Vehnput Dynamics Visuals Figure 11: Driving Simulator PERFORMNCE φ,θ,ψ TM2Euler udio Motion The vehicle dynamics shown in Figure 8 contains 61 states including the powertrain. They were integrated using a Runge Kutta second order method. Running the vehicle dynamics on a single 600 MHz Pentium processor was ound to take ms per update. typical update rate or the model is 2.5 ms leaving plenty o time or other calculations. DVNTGES OF THE GRPHCL ENVRONMENT There are several advantages to using a graphical simulation tool. The simulation tool provides a structured ramework to build C Code components in. The simulation tool executes the multi-body components in the model such that all data required or the current component has been calculated in previous components. Thereore the order o calculation o position, velocity, and orce analysis steps, which would normally be laid out explicitly in recursive dynamics ormulations, are automatically determined by the ramework. Graphical simulation tools provide a uniied integration algorithm with the ability to globally set integration methods and integration time steps. t is typically easy to add states to the integrator rom any component. ny component output can be easily collected as data during the simulation and plotted. nputs to the model and initial conditions o the states can be accessed rom a single user interace. The graphical environment allows users greater insight into the model being developed. t also allows easy connections between components and provides or a hierarchical view o the model. n addition components and models are ully encapsulated and easy to share between users. This encourages component and model reuse. CONCLUSON t was ound that a multi-body vehicle dynamics model and a driving simulator could be designed using modular components. Links, joints, masses, and orces mapped well into independent components. The multi-body components were ound to accurately model both a double pendulum and a Ford Taurus. The perormance o the model was ound to be extremely eicient taking only ms per time step to model the Ford Taurus on a 600 MHz Pentium. This makes the model usable or real-time simulation. CONTCT Richard Romano has been working in driving simulation or twelve years ocusing on motion cueing, vehicle dynamics, and human actors research. Dr. Romano was the manager o simulator research and development at the owa Driving Simulator and supervised the brake system simulation group at TT utomotive. He is now president o Realtime Technologies, nc. He may be contacted at raromano@ix.netcom.com. REFERENCES 1. Schiehlen, W., Multibody System Dynamics: Roots and Perspectives, Multibody System Dynamics 1: , Kinematics and Dynamics o Multi-ody Systems, Eds. J. ngeles and. Kecskeméthy, CSM Courses and Lectures No. 360, Springer-Verlag, Wien, New York, Krebs, M., Vehicle Modeling or High- Dynamic Driving Simulator pplications, Proceedings o the 1st Human-Centered Transportation Simulation Conerence, owa City,, Craig, J.J., ntroduction to Robotics Mechanics and Control, ddison Wesley, New York, Walker, M. W. and D. E. Orin., Eicient Dynamic Computer Simulation o Robotic Mechanisms, SME Journal o Dynamic Systems, Measurements and Control, Vol. 104, 1982, pp Hwang, H.Y., Kim, S.S., Haug, E.J., and H.J. Lai, Theoretical Cross Veriications and Comparative Studies o Multibody Simulation Codes DDS, DSCOS, and Contops, Technical Report R-66, Center or Simulation and Design Optimization, University o owa, Sayers, M. W. and D. Han. Generic Multibody Vehicle Model or Simulating Handling and raking. Journal o Vehicle System Dynamics, Supplement 25, 1996, pp Romano, R., Realtime Driving Simulation Using Modular Modeling Methodology, SE Technical Paper Series No , March Salaani, M.K., Parameter Measurement and Development o a NDSdyna Validation Data Set or a 1994 Ford Taurus, SE Technical Paper Series No , February, Salaani, M.K., Heydinger, G.J., and D.. Guenther, Validation Results rom Using NDSdyna Vehicle Dynamics Simulation, SE Technical Paper Series No , February, 1997.

6 11. Salaani, M.K., and G.J. Heydinger, Powertrain and rake Modeling o the 1994 Ford Taurus or the National dvanced Driving Simulator, SE Technical Paper Series No , March, 1998.

Using RecurDyn. Contents

Using RecurDyn. Contents Using RecurDyn Contents 1.0 Multibody Dynamics Overview... 2 2.0 Multibody Dynamics Applications... 3 3.0 What is RecurDyn and how is it different?... 4 4.0 Types of RecurDyn Analysis... 5 5.0 MBD Simulation

More information

What Is SimMechanics?

What Is SimMechanics? SimMechanics 1 simulink What Is Simulink? Simulink is a tool for simulating dynamic systems with a graphical interface specially developed for this purpose. Physical Modeling runs within the Simulink environment

More information

Rotational3D Efficient modelling of 3D effects in rotational mechanics

Rotational3D Efficient modelling of 3D effects in rotational mechanics Rotational3D - Efficient Modelling of 3D Effects in Rotational Mechanics Rotational3D Efficient modelling of 3D effects in rotational mechanics Johan Andreasson Magnus Gäfvert Modelon AB Ideon Science

More information

AC : DEVELOPMENT OF A ROBOTIC PLATFORM FOR TEACH- ING MODEL-BASED DESIGN TECHNIQUES IN DYNAMICS AND CON- TROL PROGRAM

AC : DEVELOPMENT OF A ROBOTIC PLATFORM FOR TEACH- ING MODEL-BASED DESIGN TECHNIQUES IN DYNAMICS AND CON- TROL PROGRAM AC 011-714: DEVELOPMENT OF A ROBOTIC PLATFORM FOR TEACH- ING MODEL-BASED DESIGN TECHNIQUES IN DYNAMICS AND CON- TROL PROGRAM Bingen Yang, University o Southern Caliornia Dr. Bingen Yang is Proessor o Aerospace

More information

3D Hand and Fingers Reconstruction from Monocular View

3D Hand and Fingers Reconstruction from Monocular View 3D Hand and Fingers Reconstruction rom Monocular View 1. Research Team Project Leader: Graduate Students: Pro. Isaac Cohen, Computer Science Sung Uk Lee 2. Statement o Project Goals The needs or an accurate

More information

An Improved Dynamic Modeling of a 3-RPS Parallel Manipulator using the concept of DeNOC Matrices

An Improved Dynamic Modeling of a 3-RPS Parallel Manipulator using the concept of DeNOC Matrices An Improved Dynamic Modeling of a 3-RPS Parallel Manipulator using the concept of DeNOC Matrices A. Rahmani Hanzaki, E. Yoosefi Abstract A recursive dynamic modeling of a three-dof parallel robot, namely,

More information

Role of Kinematic Analysis in tuning the Dynamic Behavior of a Formula Car

Role of Kinematic Analysis in tuning the Dynamic Behavior of a Formula Car gopalax -International Journal of Technology And Engineering System(IJTES): Jan March 2011- Vol.2.No.3. Role of Kinematic Analysis in tuning the Dynamic Behavior of a Formula Car K. J. Prashanth 1, Ashish

More information

MPC Based Driver's Intention Prediction Method for Vehicle Stability Control

MPC Based Driver's Intention Prediction Method for Vehicle Stability Control nd International Conerence on Automation echanical and Electrical Engineering (AEE 7) PC Based Driver's Intention Prediction ethod or Vehicle Stability Control Shunhang Zheng Bangcheng Zhang Shaosong Li

More information

MTRX4700 Experimental Robotics

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

More information

Modeling of Humanoid Systems Using Deductive Approach

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

More information

Simulation-Based Design of Robotic Systems

Simulation-Based Design of Robotic Systems Simulation-Based Design of Robotic Systems Shadi Mohammad Munshi* & Erik Van Voorthuysen School of Mechanical and Manufacturing Engineering, The University of New South Wales, Sydney, NSW 2052 shadimunshi@hotmail.com,

More information

A MECHATRONIC APPROACH OF THE WINDSHIELD WIPER MECHANISMS

A MECHATRONIC APPROACH OF THE WINDSHIELD WIPER MECHANISMS A MECHATRONIC APPROACH OF THE WINDSHIELD WIPER MECHANISMS Alexandru Cătălin Transilvania University of Braşov calex@unitbv.ro Keywords: windshield wiper mechanism, dynamic simulation, control system, virtual

More information

Applications. Human and animal motion Robotics control Hair Plants Molecular motion

Applications. Human and animal motion Robotics control Hair Plants Molecular motion Multibody dynamics Applications Human and animal motion Robotics control Hair Plants Molecular motion Generalized coordinates Virtual work and generalized forces Lagrangian dynamics for mass points

More information

A Simplified Vehicle and Driver Model for Vehicle Systems Development

A Simplified Vehicle and Driver Model for Vehicle Systems Development A Simplified Vehicle and Driver Model for Vehicle Systems Development Martin Bayliss Cranfield University School of Engineering Bedfordshire MK43 0AL UK Abstract For the purposes of vehicle systems controller

More information

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

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

More information

Reduced Model Based Control of Two Link Flexible Space Robot

Reduced Model Based Control of Two Link Flexible Space Robot Intelligent Control and Automation, 0,, 0 doi:0.436/ica.0.03 Published Online May 0 (http://www.scirp.org/journal/ica) Reduced Model Based Control o Two Link Flexible Space Robot Abstract Amit Kumar, Pushparaj

More information

Lecture «Robot Dynamics»: Kinematics 3

Lecture «Robot Dynamics»: Kinematics 3 Lecture «Robot Dynamics»: Kinematics 3 151-0851-00 V lecture: CAB G11 Tuesday 10:15 12:00, every week exercise: HG E1.2 Wednesday 8:15 10:00, according to schedule (about every 2nd week) office hour: LEE

More information

Multi-objective optimization of the geometry of a double wishbone suspension system

Multi-objective optimization of the geometry of a double wishbone suspension system Multi-objective optimization of the geometry of a double wishbone suspension system Juan C. Blanco 1, Luis E. Munoz 2 University of Los Andes, Bogotá, Colombia 1 Corresponding author E-mail: 1 juan-bla@uniandes.edu.co,

More information

AUTONOMOUS PLANETARY ROVER CONTROL USING INVERSE SIMULATION

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

More information

Motion based 3D Target Tracking with Interacting Multiple Linear Dynamic Models

Motion based 3D Target Tracking with Interacting Multiple Linear Dynamic Models Motion based 3D Target Tracking with Interacting Multiple Linear Dynamic Models Zhen Jia and Arjuna Balasuriya School o EEE, Nanyang Technological University, Singapore jiazhen@pmail.ntu.edu.sg, earjuna@ntu.edu.sg

More information

Lecture «Robot Dynamics»: Multi-body Kinematics

Lecture «Robot Dynamics»: Multi-body Kinematics Lecture «Robot Dynamics»: Multi-body Kinematics 151-0851-00 V lecture: CAB G11 Tuesday 10:15 12:00, every week exercise: HG E1.2 Wednesday 8:15 10:00, according to schedule (about every 2nd week) Marco

More information

Lecture «Robot Dynamics»: Kinematics 3

Lecture «Robot Dynamics»: Kinematics 3 Lecture «Robot Dynamics»: Kinematics 3 151-0851-00 V lecture: CAB G11 Tuesday 10:15 12:00, every week exercise: HG E1.2 Wednesday 8:15 10:00, according to schedule (about every 2nd week) Marco Hutter,

More information

IN order to design, improve performance, simulate the behavior

IN order to design, improve performance, simulate the behavior International Journal o Mechanical, Industrial and Aerospace Engineering : 9 Bond Graph Modeling o Mechanical Dynamics o an Excavator or Hydraulic System Analysis and Design Mutuku Muvengei and John Kihiu,

More information

METR 4202: Advanced Control & Robotics

METR 4202: Advanced Control & Robotics Position & Orientation & State t home with Homogenous Transformations METR 4202: dvanced Control & Robotics Drs Surya Singh, Paul Pounds, and Hanna Kurniawati Lecture # 2 July 30, 2012 metr4202@itee.uq.edu.au

More information

Chapter 4 Dynamics. Part Constrained Kinematics and Dynamics. Mobile Robotics - Prof Alonzo Kelly, CMU RI

Chapter 4 Dynamics. Part Constrained Kinematics and Dynamics. Mobile Robotics - Prof Alonzo Kelly, CMU RI Chapter 4 Dynamics Part 2 4.3 Constrained Kinematics and Dynamics 1 Outline 4.3 Constrained Kinematics and Dynamics 4.3.1 Constraints of Disallowed Direction 4.3.2 Constraints of Rolling without Slipping

More information

Lesson 1: Introduction to Pro/MECHANICA Motion

Lesson 1: Introduction to Pro/MECHANICA Motion Lesson 1: Introduction to Pro/MECHANICA Motion 1.1 Overview of the Lesson The purpose of this lesson is to provide you with a brief overview of Pro/MECHANICA Motion, also called Motion in this book. Motion

More information

TERRAIN-ADAPTIVE GENERATION OF OPTIMAL CONTINUOUS TRAJECTORIES FOR MOBILE ROBOTS

TERRAIN-ADAPTIVE GENERATION OF OPTIMAL CONTINUOUS TRAJECTORIES FOR MOBILE ROBOTS ERRAIN-ADAPIVE GENERAION OF OPIMAL CONINUOUS RAJECORIES FOR MOBILE ROBOS homas M. Howard (1, Alonzo Kelly ( (1 Carnegie Mellon University, Robotics Institute, 5 Forbes Ave., Pittsburgh, PA 1513, USA, thoward@cs.cmu.edu

More information

DETC COMPARING KINEMATIC AND DYNAMIC HAND MODELS FOR INTERACTIVE GRASPING SIMULATION

DETC COMPARING KINEMATIC AND DYNAMIC HAND MODELS FOR INTERACTIVE GRASPING SIMULATION Proceedings o o the the ASME 29 International Design Engineering Technical Conerences & and Computers and Inormation in in Engineering Conerence IDETC/CIE 29 August 33-September - 2, 2, 29, San Diego,

More information

/08/$ IFAC / KR

/08/$ IFAC / KR Proceedings o the 7th World Congress he International Federation o Automatic Control RES-O-RES SLEW MANEUVER OF HREE-AXIS ROAIONAL FLEXIBLE SPACECRAF Jae Jun Kim and Brij N. Agrawal 2 Naval Postgraduate

More information

Development of Production Environment for Motion Contents for Humans, Animals, and Other Structures

Development of Production Environment for Motion Contents for Humans, Animals, and Other Structures UDC 621.397.3:681.32 Development of Production Environment for Motion Contents for Humans, Animals, and Other Structures VFumio Nagashima (Manuscript received June 17, 1999) This paper proposes an efficient

More information

Dynamic Analysis of Manipulator Arm for 6-legged Robot

Dynamic Analysis of Manipulator Arm for 6-legged Robot American Journal of Mechanical Engineering, 2013, Vol. 1, No. 7, 365-369 Available online at http://pubs.sciepub.com/ajme/1/7/42 Science and Education Publishing DOI:10.12691/ajme-1-7-42 Dynamic Analysis

More information

PSO based Adaptive Force Controller for 6 DOF Robot Manipulators

PSO based Adaptive Force Controller for 6 DOF Robot Manipulators , October 25-27, 2017, San Francisco, USA PSO based Adaptive Force Controller for 6 DOF Robot Manipulators Sutthipong Thunyajarern, Uma Seeboonruang and Somyot Kaitwanidvilai Abstract Force control in

More information

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

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

More information

MOVING CAMERA ROTATION ESTIMATION USING HORIZON LINE FEATURES MOTION FIELD

MOVING CAMERA ROTATION ESTIMATION USING HORIZON LINE FEATURES MOTION FIELD MOVING CAMERA ROTATION ESTIMATION USING HORION LINE FEATURES MOTION FIELD S. Nedevschi, T. Marita, R. Danescu, F. Oniga, C. Pocol Computer Science Department Technical University o Cluj-Napoca Cluj-Napoca,

More information

Lecture 2: Kinematics of medical robotics

Lecture 2: Kinematics of medical robotics ME 328: Medical Robotics Autumn 2016 Lecture 2: Kinematics of medical robotics Allison Okamura Stanford University kinematics The study of movement The branch of classical mechanics that describes the

More information

2. Motion Analysis - Sim-Mechanics

2. Motion Analysis - Sim-Mechanics 2 Motion Analysis - Sim-Mechanics Figure 1 - The RR manipulator frames The following table tabulates the summary of different types of analysis that is performed for the RR manipulator introduced in the

More information

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

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

More information

Design of a Three-Axis Rotary Platform

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

More information

Automated Parameterization of the Joint Space Dynamics of a Robotic Arm. Josh Petersen

Automated Parameterization of the Joint Space Dynamics of a Robotic Arm. Josh Petersen Automated Parameterization of the Joint Space Dynamics of a Robotic Arm Josh Petersen Introduction The goal of my project was to use machine learning to fully automate the parameterization of the joint

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

Model Library Mechanics

Model Library Mechanics Model Library Mechanics Using the libraries Mechanics 1D (Linear), Mechanics 1D (Rotary), Modal System incl. ANSYS interface, and MBS Mechanics (3D) incl. CAD import via STL and the additional options

More information

Chapter 1: Introduction

Chapter 1: Introduction Chapter 1: Introduction This dissertation will describe the mathematical modeling and development of an innovative, three degree-of-freedom robotic manipulator. The new device, which has been named the

More information

Robot mechanics and kinematics

Robot mechanics and kinematics University of Pisa Master of Science in Computer Science Course of Robotics (ROB) A.Y. 2016/17 cecilia.laschi@santannapisa.it http://didawiki.cli.di.unipi.it/doku.php/magistraleinformatica/rob/start Robot

More information

Robotics kinematics and Dynamics

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

More information

Automatic Generation of Real-Time Simulation Code for Vehicle Dynamics using Linear Graph Theory and Symbolic Computing

Automatic Generation of Real-Time Simulation Code for Vehicle Dynamics using Linear Graph Theory and Symbolic Computing Automatic Generation of Real-Time Simulation Code for Vehicle Dynamics using Linear Graph Theory and Symbolic Computing by Kevin Warren Morency A thesis presented to the University of Waterloo in fulfillment

More information

VEHICLE MODELING FOR HIGH-DYNAMIC DRIVING SIMULATOR APPLICATIONS

VEHICLE MODELING FOR HIGH-DYNAMIC DRIVING SIMULATOR APPLICATIONS VEHICLE MODELING FOR HIGH-DYNMIC DRIVING SIMULTOR PPLICTIONS Martin Krebs Oerlikon Contraves G irchstrasse 155 CH-8050 Zürich, Switzerland phone: +41 1 316 26 09 fax: +41 1 316 20 32 e-mail: martin.krebs@ocag.ch

More information

Analysis of mechanisms with flexible beam-like links, rotary joints and assembly errors

Analysis of mechanisms with flexible beam-like links, rotary joints and assembly errors Arch Appl Mech (2012) 82:283 295 DOI 10.1007/s00419-011-0556-6 ORIGINAL Krzysztof Augustynek Iwona Adamiec-Wójcik Analysis of mechanisms with flexible beam-like links, rotary joints and assembly errors

More information

COPYRIGHTED MATERIAL INTRODUCTION CHAPTER 1

COPYRIGHTED MATERIAL INTRODUCTION CHAPTER 1 CHAPTER 1 INTRODUCTION Modern mechanical and aerospace systems are often very complex and consist of many components interconnected by joints and force elements such as springs, dampers, and actuators.

More information

Optimization of a two-link Robotic Manipulator

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

More information

SYNTHESIS OF PLANAR MECHANISMS FOR PICK AND PLACE TASKS WITH GUIDING LOCATIONS

SYNTHESIS OF PLANAR MECHANISMS FOR PICK AND PLACE TASKS WITH GUIDING LOCATIONS Proceedings of the ASME 2013 International Design Engineering Technical Conferences and Computers and Information in Engineering Conference IDETC/CIE 2013 August 4-7, 2013, Portland, Oregon, USA DETC2013-12021

More information

Mobile Robotics. Mathematics, Models, and Methods. HI Cambridge. Alonzo Kelly. Carnegie Mellon University UNIVERSITY PRESS

Mobile Robotics. Mathematics, Models, and Methods. HI Cambridge. Alonzo Kelly. Carnegie Mellon University UNIVERSITY PRESS Mobile Robotics Mathematics, Models, and Methods Alonzo Kelly Carnegie Mellon University HI Cambridge UNIVERSITY PRESS Contents Preface page xiii 1 Introduction 1 1.1 Applications of Mobile Robots 2 1.2

More information

Road Sign Analysis Using Multisensory Data

Road Sign Analysis Using Multisensory Data Road Sign Analysis Using Multisensory Data R.J. López-Sastre, S. Lauente-Arroyo, P. Gil-Jiménez, P. Siegmann, and S. Maldonado-Bascón University o Alcalá, Department o Signal Theory and Communications

More information

KINEMATIC AND DYNAMIC SIMULATION OF A 3DOF PARALLEL ROBOT

KINEMATIC AND DYNAMIC SIMULATION OF A 3DOF PARALLEL ROBOT Bulletin of the Transilvania University of Braşov Vol. 8 (57) No. 2-2015 Series I: Engineering Sciences KINEMATIC AND DYNAMIC SIMULATION OF A 3DOF PARALLEL ROBOT Nadia Ramona CREŢESCU 1 Abstract: This

More information

Kinematic and Dynamic Analysis of Stephenson Six Bar Mechanism Using HyperWorks

Kinematic and Dynamic Analysis of Stephenson Six Bar Mechanism Using HyperWorks Kinematic and Dynamic Analysis of Stephenson Six Bar Mechanism Using HyperWorks Kailash Chaudhary Phd Scholar Malaviya National Institute of Technology,Jaipur JLN Marg, Jaipur - 302 017, India Dr. Himanshu

More information

Xavier: A Robot Navigation Architecture Based on Partially Observable Markov Decision Process Models

Xavier: A Robot Navigation Architecture Based on Partially Observable Markov Decision Process Models Xavier: A Robot Navigation Architecture Based on Partially Observable Markov Decision Process Models Sven Koenig and Reid G. Simmons Carnegie Mellon University School o Computer Science Pittsburgh, PA

More information

Dynamics Analysis for a 3-PRS Spatial Parallel Manipulator-Wearable Haptic Thimble

Dynamics Analysis for a 3-PRS Spatial Parallel Manipulator-Wearable Haptic Thimble Dynamics Analysis for a 3-PRS Spatial Parallel Manipulator-Wearable Haptic Thimble Masoud Moeini, University of Hamburg, Oct 216 [Wearable Haptic Thimble,A Developing Guide and Tutorial,Francesco Chinello]

More information

WEEKS 1-2 MECHANISMS

WEEKS 1-2 MECHANISMS References WEEKS 1-2 MECHANISMS (METU, Department of Mechanical Engineering) Text Book: Mechanisms Web Page: http://www.me.metu.edu.tr/people/eres/me301/in dex.ht Analitik Çözümlü Örneklerle Mekanizma

More information

Automatic Control Industrial robotics

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

More information

DYNAMIC SIMULATION OF A FORMULA SAE RACING CAR FOR DESIGN AND DEVELOPMENT PURPOSES

DYNAMIC SIMULATION OF A FORMULA SAE RACING CAR FOR DESIGN AND DEVELOPMENT PURPOSES MULTIBODY DYNAMICS 29, ECCOMAS Thematic Conference K. Arczewski, J. Frączek, M. Wojtyra (eds.) Warsaw, Poland, 29 June 2 July 29 DYNAMIC SIMULATION OF A FORMULA SAE RACING CAR FOR DESIGN AND DEVELOPMENT

More information

A 6DOF Motion Platform with Permanent Magnet Linear Motors

A 6DOF Motion Platform with Permanent Magnet Linear Motors Transactions on Electrical Engineering, Vol. 3 (), No. A DO Motion Platform with Permanent Magnet Linear Motors Evžen Thöndel Department of Electric Drives and Traction, Czech Technical University in Prague,

More information

Triangulation: A new algorithm for Inverse Kinematics

Triangulation: A new algorithm for Inverse Kinematics Triangulation: A new algorithm for Inverse Kinematics R. Müller-Cajar 1, R. Mukundan 1, 1 University of Canterbury, Dept. Computer Science & Software Engineering. Email: rdc32@student.canterbury.ac.nz

More information

SimMechanics Getting Started Guide. R2013b

SimMechanics Getting Started Guide. R2013b SimMechanics Getting Started Guide R2013b How to Contact MathWorks www.mathworks.com Web comp.soft-sys.matlab Newsgroup www.mathworks.com/contact_ts.html Technical Support suggest@mathworks.com bugs@mathworks.com

More information

Robot mechanics and kinematics

Robot mechanics and kinematics University of Pisa Master of Science in Computer Science Course of Robotics (ROB) A.Y. 2017/18 cecilia.laschi@santannapisa.it http://didawiki.cli.di.unipi.it/doku.php/magistraleinformatica/rob/start Robot

More information

Computer Aided Dynamic Simulation of Six- Legged Robot

Computer Aided Dynamic Simulation of Six- Legged Robot Computer Aided Dynamic Simulation of Six- Legged Robot Abhijit Mahapatra 1, and Shibendu Shekhar Roy 2 1 Virtual Prototyping & Immersive Visualization Laboratory, Central Mechanical Engineering Research

More information

INTRODUCTION CHAPTER 1

INTRODUCTION CHAPTER 1 CHAPTER 1 INTRODUCTION Modern mechanical and aerospace systems are often very complex and consist of many components interconnected by joints and force elements such as springs, dampers, and actuators.

More information

State Estimation and Parameter Identification of Flexible Manipulators Based on Visual Sensor and Virtual Joint Model

State Estimation and Parameter Identification of Flexible Manipulators Based on Visual Sensor and Virtual Joint Model Proceedings of the 2001 IEEE International Conference on Robotics & Automation Seoul, Korea May 21-26, 2001 State Estimation and Parameter Identification of Flexible Manipulators Based on Visual Sensor

More information

Quick Start Training Guide

Quick Start Training Guide Quick Start Training Guide Table of Contents 1 INTRODUCTION TO MAPLESIM... 5 1.1 USER INTERFACE... 5 2 WORKING WITH A SAMPLE MODEL... 7 2.1 RUNNING A SIMULATION... 7 2.2 GRAPHICAL OUTPUT... 7 2.3 3D VISUALIZATION...

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

AC : AN ALTERNATIVE APPROACH FOR TEACHING MULTIBODY DYNAMICS

AC : AN ALTERNATIVE APPROACH FOR TEACHING MULTIBODY DYNAMICS AC 2009-575: AN ALTERNATIVE APPROACH FOR TEACHING MULTIBODY DYNAMICS George Sutherland, Rochester Institute of Technology DR. GEORGE H. SUTHERLAND is a professor in the Manufacturing & Mechanical Engineering

More information

VIRTUAL PROTOTYPING SIMULATION FOR THE DESIGN OF TWO-WHEELED VEHICLES

VIRTUAL PROTOTYPING SIMULATION FOR THE DESIGN OF TWO-WHEELED VEHICLES NTERNATIONAL DESIGN CONFERENCE - DESIGN 2002 Dubrovnik, May 14-17, 2002. VIRTUAL PROTOTYPING SIMULATION FOR THE DESIGN OF TWO-WHEELED VEHICLES S. Barone, A. Curcio and F. Pierucci Keywords: CAD, Multi-Body

More information

Singularity Handling on Puma in Operational Space Formulation

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

More information

EAEC2011 C10 X-BY-WIRE VEHICLE PROTOTYPE: A TOOL FOR RESEARCH ON REAL-TIME VEHICLE MULTIBODY MODELS ABSTRACT

EAEC2011 C10 X-BY-WIRE VEHICLE PROTOTYPE: A TOOL FOR RESEARCH ON REAL-TIME VEHICLE MULTIBODY MODELS ABSTRACT EAEC211 C1 X-BY-WIRE VEHICLE PROTOTYPE: A TOOL FOR RESEARCH ON REAL-TIME VEHICLE MULTIBODY MODELS Pastorino Roland, Naya Miguel, Luaces Alberto, Cuadrado Javier Mechanical Engineering Laboratory of the

More information

10/11/07 1. Motion Control (wheeled robots) Representing Robot Position ( ) ( ) [ ] T

10/11/07 1. Motion Control (wheeled robots) Representing Robot Position ( ) ( ) [ ] T 3 3 Motion Control (wheeled robots) Introduction: Mobile Robot Kinematics Requirements for Motion Control Kinematic / dynamic model of the robot Model of the interaction between the wheel and the ground

More information

A Proposed Approach for Solving Rough Bi-Level. Programming Problems by Genetic Algorithm

A Proposed Approach for Solving Rough Bi-Level. Programming Problems by Genetic Algorithm Int J Contemp Math Sciences, Vol 6, 0, no 0, 45 465 A Proposed Approach or Solving Rough Bi-Level Programming Problems by Genetic Algorithm M S Osman Department o Basic Science, Higher Technological Institute

More information

1. Introduction 1 2. Mathematical Representation of Robots

1. Introduction 1 2. Mathematical Representation of Robots 1. Introduction 1 1.1 Introduction 1 1.2 Brief History 1 1.3 Types of Robots 7 1.4 Technology of Robots 9 1.5 Basic Principles in Robotics 12 1.6 Notation 15 1.7 Symbolic Computation and Numerical Analysis

More information

Flexible multibody systems - Relative coordinates approach

Flexible multibody systems - Relative coordinates approach Computer-aided analysis of multibody dynamics (part 2) Flexible multibody systems - Relative coordinates approach Paul Fisette (paul.fisette@uclouvain.be) Introduction In terms of modeling, multibody scientists

More information

3-D TERRAIN RECONSTRUCTION WITH AERIAL PHOTOGRAPHY

3-D TERRAIN RECONSTRUCTION WITH AERIAL PHOTOGRAPHY 3-D TERRAIN RECONSTRUCTION WITH AERIAL PHOTOGRAPHY Bin-Yih Juang ( 莊斌鎰 ) 1, and Chiou-Shann Fuh ( 傅楸善 ) 3 1 Ph. D candidate o Dept. o Mechanical Engineering National Taiwan University, Taipei, Taiwan Instructor

More information

Sensor Accuracy in Vehicle Safety

Sensor Accuracy in Vehicle Safety Sensor Accuracy in Vehicle Safety Sas Harrison Claytex Services Ltd. Leamington Spa UK Global Business: Software Support Consultancy Training Expertise: Modelica / C++ Software Simulation Libraries Systems

More information

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

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

More information

FUNCTIONAL OPTIMIZATION OF WINDSHIELD WIPER MECHANISMS IN MBS (MULTI-BODY SYSTEM) CONCEPT

FUNCTIONAL OPTIMIZATION OF WINDSHIELD WIPER MECHANISMS IN MBS (MULTI-BODY SYSTEM) CONCEPT FUNCTIONAL OPTIMIZATION OF WINDSHIELD WIPER MECHANISMS IN MBS (MULTI-BODY SYSTEM) CONCEPT Cătălin ALEXANDRU 1 Abstract: In this paper, the functional optimization of windshield wiper mechanisms is performed,

More information

Introduction to Solid Modeling Using SolidWorks 2008 COSMOSMotion Tutorial Page 1

Introduction to Solid Modeling Using SolidWorks 2008 COSMOSMotion Tutorial Page 1 Introduction to Solid Modeling Using SolidWorks 2008 COSMOSMotion Tutorial Page 1 In this tutorial, we will learn the basics of performing motion analysis using COSMOSMotion. Although the tutorial can

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

Geometry of a single camera. Odilon Redon, Cyclops, 1914

Geometry of a single camera. Odilon Redon, Cyclops, 1914 Geometr o a single camera Odilon Redon, Cclops, 94 Our goal: Recover o 3D structure Recover o structure rom one image is inherentl ambiguous??? Single-view ambiguit Single-view ambiguit Rashad Alakbarov

More information

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

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

More information

θ x Week Date Lecture (M: 2:05p-3:50, 50-N202) 1 23-Jul Introduction + Representing Position & Orientation & State 2 30-Jul

θ x Week Date Lecture (M: 2:05p-3:50, 50-N202) 1 23-Jul Introduction + Representing Position & Orientation & State 2 30-Jul θ x 2018 School of Information Technology and Electrical Engineering at the University of Queensland Lecture Schedule Week Date Lecture (M: 2:05p-3:50, 50-N202) 1 23-Jul Introduction + Representing Position

More information

Serial Manipulator Statics. Robotics. Serial Manipulator Statics. Vladimír Smutný

Serial Manipulator Statics. Robotics. Serial Manipulator Statics. Vladimír Smutný Serial Manipulator Statics Robotics Serial Manipulator Statics Vladimír Smutný Center for Machine Perception Czech Institute for Informatics, Robotics, and Cybernetics (CIIRC) Czech Technical University

More information

Robotics I. March 27, 2018

Robotics I. March 27, 2018 Robotics I March 27, 28 Exercise Consider the 5-dof spatial robot in Fig., having the third and fifth joints of the prismatic type while the others are revolute. z O x Figure : A 5-dof robot, with a RRPRP

More information

Basilio Bona ROBOTICA 03CFIOR 1

Basilio Bona ROBOTICA 03CFIOR 1 Kinematic chains 1 Readings & prerequisites Chapter 2 (prerequisites) Reference systems Vectors Matrices Rotations, translations, roto-translations Homogeneous representation of vectors and matrices Chapter

More information

Gesture Recognition using a Probabilistic Framework for Pose Matching

Gesture Recognition using a Probabilistic Framework for Pose Matching Gesture Recognition using a Probabilistic Framework or Pose Matching Ahmed Elgammal Vinay Shet Yaser Yacoob Larry S. Davis Computer Vision Laboratory University o Maryland College Park MD 20742 USA elgammalvinayyaserlsd

More information

[9] D.E. Whitney, "Resolved Motion Rate Control of Manipulators and Human Prostheses," IEEE Transactions on Man-Machine Systems, 1969.

[9] D.E. Whitney, Resolved Motion Rate Control of Manipulators and Human Prostheses, IEEE Transactions on Man-Machine Systems, 1969. 160 Chapter 5 Jacobians: velocities and static forces [3] I. Shames, Engineering Mechanics, 2nd edition, Prentice-Hall, Englewood Cliffs, NJ, 1967. [4] D. Orin and W. Schrader, "Efficient Jacobian Determination

More information

Kinematics of Closed Chains

Kinematics of Closed Chains Chapter 7 Kinematics of Closed Chains Any kinematic chain that contains one or more loops is called a closed chain. Several examples of closed chains were encountered in Chapter 2, from the planar four-bar

More information

PRACTICAL SESSION 4: FORWARD DYNAMICS. Arturo Gil Aparicio.

PRACTICAL SESSION 4: FORWARD DYNAMICS. Arturo Gil Aparicio. PRACTICAL SESSION 4: FORWARD DYNAMICS Arturo Gil Aparicio arturo.gil@umh.es OBJECTIVES After this practical session, the student should be able to: Simulate the movement of a simple mechanism using the

More information

DETC THREE-DIMENSIONAL KINEMATIC ANALYSIS OF THE ACTUATED SPOKE WHEEL ROBOT. September 10-13, 2006, Philadelphia, Pennsylvania, USA

DETC THREE-DIMENSIONAL KINEMATIC ANALYSIS OF THE ACTUATED SPOKE WHEEL ROBOT. September 10-13, 2006, Philadelphia, Pennsylvania, USA Proceedings Proceedings of IDETC/CIE of IDETC 06 2006 ASME 2006 ASME International International Design Design Engineering Engineering Technical Technical Conferences Conferences & September Computers

More information

A New Algorithm for Measuring and Optimizing the Manipulability Index

A New Algorithm for Measuring and Optimizing the Manipulability Index DOI 10.1007/s10846-009-9388-9 A New Algorithm for Measuring and Optimizing the Manipulability Index Ayssam Yehia Elkady Mohammed Mohammed Tarek Sobh Received: 16 September 2009 / Accepted: 27 October 2009

More information

MBS MODELLING WITH SIMMECHANICS: CASE STUDIES IN RESEARCH AND EDUCATION

MBS MODELLING WITH SIMMECHANICS: CASE STUDIES IN RESEARCH AND EDUCATION MBS MODELLING WITH SIMMECHANICS: CASE STUDIES IN RESEARCH AND EDUCATION Grepl, R., Lee, B., Singule, V., Švejda, P., Vlachý, D., Zezula, P. Laboratory of mechatronics, FME, Brno University of Technology

More information

10. SOPC Builder Component Development Walkthrough

10. SOPC Builder Component Development Walkthrough 10. SOPC Builder Component Development Walkthrough QII54007-9.0.0 Introduction This chapter describes the parts o a custom SOPC Builder component and guides you through the process o creating an example

More information

Reconfigurable Manipulator Simulation for Robotics and Multimodal Machine Learning Application: Aaria

Reconfigurable Manipulator Simulation for Robotics and Multimodal Machine Learning Application: Aaria Reconfigurable Manipulator Simulation for Robotics and Multimodal Machine Learning Application: Aaria Arttu Hautakoski, Mohammad M. Aref, and Jouni Mattila Laboratory of Automation and Hydraulic Engineering

More information

FORCE CONTROL OF LINK SYSTEMS USING THE PARALLEL SOLUTION SCHEME

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

More information

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

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

More information

A New Algorithm for Measuring and Optimizing the Manipulability Index

A New Algorithm for Measuring and Optimizing the Manipulability Index A New Algorithm for Measuring and Optimizing the Manipulability Index Mohammed Mohammed, Ayssam Elkady and Tarek Sobh School of Engineering, University of Bridgeport, USA. Mohammem@bridgeport.edu Abstract:

More information