Appendix A Physiological Model of the Elbow in MATLAB/Simulink

Size: px
Start display at page:

Download "Appendix A Physiological Model of the Elbow in MATLAB/Simulink"

Transcription

1 Appendix A Physiological Model of the Elbow in MATLAB/Simulink This section contains a complete description of the implementation of the physiological model of the elbow joint in the MATLAB/Simulink environment. The highest level of the Simulink block model diagram is shown in Fig. A.1. The inputs to the model are from two MATLAB data files: data.mat, which contains the raw EMG signal data from the biceps and triceps muscles, and the motion data from the Polaris Spectra optical tracking system; and tuning.mat, which contains the tuned parameter values for a particular subject. The outputs of the Simulink model include the predicted movement from the physiological model, the actual movement measured by the tracking system and the error between the two values (used to determine RMSE). The submodel EMG Model contains the physiological model and is shown in Fig. A.2. The subsystems of the model have been grouped according to their function (in red), and their structure and purpose will be described in the remainder of this section. A.1 Subsystem A This subsystem performs the LEP of the raw EMG signals from the biceps and triceps muscles. The block model is shown in Fig. A.3 and it outputs the normalised activation level of both muscles. Springer International Publishing Switzerland 2016 S.(S.Q.) Xie, Advanced Robotics for Medical Rehabilitation, Springer Tracts in Advanced Robotics 108, DOI /

2 324 Appendix A: Physiological Model of the Elbow in MATLAB/Simulink Fig. A.1 Top level view of the elbow joint Simulink model Fig. A.2 Physiological model block diagram in Simulink

3 Appendix A: Physiological Model of the Elbow in MATLAB/Simulink 325 Fig. A.3 EMG signal processing subsystem A.2 Subsystems B and C: The Musculotendon Model These subsystems are identical with B for the biceps group and C for the triceps group. The parameters for the model are passed into the embedded MATLAB function from the Simulink model. The code for the function is shown below: 1 % This function is a generic method for calculating the force of a muscle 2 % given its activation level and physical properties. The function should 3 % be able to be used with any muscle given that the relevant properties 4 % have been defined. This includes the input arguments shown below. The 5 % output of the function is total muscle force. 6 7 % A activation level 8 % length current muscle length 9 % lengthmax maximum muscle length 10 % lengthopt optimal muscle length 11 % Fmax maximum muscle force 12 % Cpass tendon stiffness 13 % U_sc muscle size % Author: James Pau 16 % Date: 11 November

4 326 Appendix A: Physiological Model of the Elbow in MATLAB/Simulink 18 % UPDATE: 23 March % Implementing new musculotendon model (one that has been justified from 20 % the literature) function F = calculateforce(length,length_prev,a,fmax,lengthopt, vmax,cpass,sampling_time,u_sc,cdamp) % Find passive force due to the tissue elasticity 26 l_norm = length/lengthopt; 27 Fpass = exp(cpass*10*(l_norm 1))/exp(5)*Fmax; % Find force length relationship 30 F_leng = 1 ((l_norm 1)/0.5)^2; % Find force velocity relationship 33 v_norm = ((length length_prev)/sampling_time)/(0.5*vmax*(a+1)); % From Rosen 36 F_vel = /( exp( 1.409*sinh(3.2*v_norm+1.6))); F_visc = Fmax*Cdamp*v_norm; % Find total force 41 F = U_sc * Fmax * A * F_leng * F_vel + Fpass + F_visc; A.3 Subsystem D: Musculoskeletal Model 1 % This function calculates the moment generated at the elbow joint. The 2 % function is joint specific because it depends on the geometry of the 3 % joint and number of active muscle groups (in this case two). The input 4 % arguments to the function are the forces calculated using calculateforce 5 % and joint geometries. 6 7 % Author: James Pau 8 % Date: 13 November % UPDATE: 6 March % Changed inputs to suit use in Embedded MATLAB function % UPDATE: 8 March 2010

5 Appendix A: Physiological Model of the Elbow in MATLAB/Simulink 327

6 328 Appendix A: Physiological Model of the Elbow in MATLAB/Simulink A.4 Subsystem E: Kinematic Model Implementation of the kinematic model.

7 Appendix A: Physiological Model of the Elbow in MATLAB/Simulink 329

8 Appendix B Optimal 4R Mechanism Configurations Optimal 4R mechanism configurations were obtained for reaching 89 uniformly separated upper arm positions in the workspace during the optimisation process. The 89 optimal configurations for the left shoulder are presented in this appendix (Figs. B.1, B.2 and B.3; Table B.1). B.1 Motor Requirements In the selection of a specific motor actuator for each of the five joints in the upper limb exoskeleton, multiple factors are considered including performance, range of motion, weight, size, back-drivability and cost. The performance requirements are torque and velocity which are approximated by considering slightly extreme scenarios of human upper limb movement. The assumed velocity requirement for the shoulder and elbow joints is half a revolution per second or 30 rpm which is reasonably fast compared to movements Fig. B.1 The 89 uniformly separated points in the workspace of the left shoulder Springer International Publishing Switzerland 2016 S.(S.Q.) Xie, Advanced Robotics for Medical Rehabilitation, Springer Tracts in Advanced Robotics 108, DOI /

9 332 Appendix B: Optimal 4R Mechanism Configurations Fig. B.2 Numbers assigned to the 89 workspace points. The red points are not used in the GUI for operating the exoskeleton as they are considered dangerous for the user Fig. B.3 Default configuration of the 5-DOF exoskeleton

10 Appendix B: Optimal 4R Mechanism Configurations 333 Table B.1 Optimal joint angles for reaching the 89 workspace points Point th1 th2 th3 Point th1 th2 th

11 334 Appendix B: Optimal 4R Mechanism Configurations Table B.2 Actuator requirements Exoskeleton joint Requirements Velocity (rpm) Torque (Nm) in performing common tasks. This velocity requirement of 30 rpm is assumed for Joints 1, 2 and 5 for simplicity. The actual velocity requirements of Joints 1 and 2 in the 4R mechanism will be similar to this value for a shoulder rotation velocity of 30 rpm since the 4R mechanism is optimised to operate far away from singular configurations. Due to the smaller range of motion of Joints 3 and 4, the velocity requirement for these two joints is approximated as 20 rpm. The torque requirement considers the weight which the joint needs to support as well as the potential torque applied by the user s limb. The torques caused by inertia, Coriolis and centrifugal effects are small since the exoskeleton operates at low accelerations and velocities and therefore are not considered in the torque requirement calculations. Firstly, the joint torque caused by the weight of the exoskeleton components and the user s upper limb is considered. Since the weight of the exoskeleton upper limb system shifts during operation, simulation of a 3D CAD model of the exoskeleton in Creo Parametric is used to estimate the maximum torques that occur for each joint. These occur when the upper limb is lifted to a straight horizontal position. Next, the user-generated torque is approximated by applying a 25 N force at the hand position of the horizontally positioned limb. The load torque caused by the weight of motors and gearboxes chosen for distal joints are also considered in the calculation. The approximated requirements of joint velocity and torque are provided in Table B.2. Note that the estimated torque requirement of Joint 1 is smaller than all the other joints even though it is supporting more components. This is because the axis of rotation of Joint 1 is constantly tilted resulting in a reduced component of gravitational torque acting about the joint axis. In addition, the majority of the exoskeleton mass is near the vertical plane intersecting the axis of Joint 1 during operation; therefore, the horizontal perpendicular distance to the centre of mass is small (Fig. B.4). Joint 2 has a large estimated torque requirement because the axis of rotation of Joint 2 can enter a near horizontal position during operation which maximises the load carried by the joint. Furthermore, the exoskeleton structures supported by Joint 2 tend towards one side of the joint axis (Fig. B.5). This also applies to Joint 3 which also has a relatively large torque requirement. The torque and velocity output of a motor are inversely proportional; therefore, the actuator requirements in Table B.1 refer to the exertion of torque while operating at the specified velocity. A motor can exert a larger torque than the nominal

12 Appendix B: Optimal 4R Mechanism Configurations 335 Fig. B.4 The moment acting about Joint 1 axis due to gravitational forces is relatively small due to the large angle between the Joint 1 axis and the horizontal plane and the short perpendicular distance to the weight of the system

13 336 Appendix B: Optimal 4R Mechanism Configurations Fig. B.5 The moment acting about Joint 2 axis due to gravitational forces is relatively large due to the small angle between the Joint 2 axis and the horizontal plane and the large perpendicular distance to the weight of the system

14 Appendix B: Optimal 4R Mechanism Configurations 337 Table B.3 Specifications of the motor gearbox units Joint Motor gearbox combination Nominal gearbox output Maxon motor Gearbox (r:1) Speed h _ nom (rpm) Torque s nom (Nm) 1 EC 45 Flat 50 W 24 V 156:1 planetary EC 90 Flat 90 W 24 V 91:1 planetary EC 45 Flat 50 W 24 V 319:1 planetary EC 45 Flat 50 W 24 V 47:1 spur (18.6 a ) 3.0 (18.0 a ) 5 EC 45 Flat 50 W 24 V 156:1 planetary a Values after a further reduction of 6:1 by the Joint 4 rail mechanism torque if it is running slower than the nominal velocity and can run at a higher velocity than the nominal velocity if the exerted torque is lower. The exoskeleton is not expected to operate the motors at both the required torque and velocity simultaneously. Therefore, the torque and velocity requirements are an overestimation and are only used as a guideline during motor selection. The weight and especially size of the motors are also important to ensure the motors can fit in the limited space in the exoskeleton structure. B.2 Motor Selection The motors chosen to actuate each of the five exoskeleton joints are Maxon 24V brushless DC motors in combination with reduction gearboxes (Maxon Motor, Switzerland). These motors are back-drivable and have a special flat design which allows them to be mounted directly at the exoskeleton joints without causing interference problems. Maxon ESCON controllers are used to drive each motor. The motor gearbox combinations are carefully selected for each joint (see Table B.3) to ensure the required output torque and velocity specified in Table B.2 can be achieved. Due to the high torque and low speed requirement of the exoskeleton joints, a high reduction ratio is required from the gearboxes. The gearboxes used for Joints 1, 2, 3 and 5 are planetary gearboxes with three stages of reduction for Joints 1, 2 and 5 and four stages of reduction for Joint 3. A spur gearbox with three stage reduction is used for Joint 4. In addition, the weight and size of each motor gearbox unit are also considered in conjunction with the structural design of the exoskeleton to ensure they can be mounted directly at the exoskeleton joints without interfering with the movements of the exoskeleton. Interference analysis is done by simulating a 3D CAD model of the exoskeleton system in Creo Parametric. In particular, extra attention was made in selecting the motor gearbox units and designing the exoskeleton structure for Joints 3 and 4 since attaching the motor gearbox unit onto these joints most likely causes interference. A motor gearbox unit on Joint 3 can interfere with Link 1 (the link between Joint 1 and Joint 2) when it overlaps with Link 2 (the link between Joint 2 and Joint 3) as shown in Fig. B.6a. The structure of Links 1 and 2 is

15 338 Appendix B: Optimal 4R Mechanism Configurations Fig. B.6 Potential occurrences of mechanical interference a between Joint 3 motor and Link 1 and b between Joint 4 motor and Joint 5 carefully designed to ensure this interference does not occur. In the case for Joint 4, there is very limited space available for the Joint 4 motor gearbox unit since the motor gearbox unit of Joint 5 is mounted nearby (Fig. B.6b). Therefore, a small-sized spur gearbox is selected to combine with the motor of Joint 4 instead of the larger planetary gearbox used for the other motors. The nominal output torques and velocities of the chosen motor gearbox units in Table B.3 are all similar or better than the approximated requirements in Table B.2. The motor gearbox unit for Joint 3 has the largest underperformance when compared to the proposed requirements. Although a larger motor gearbox unit would improve the performance for Joint 3, the weight of the motor gearbox unit will increase which means the motors of Joints 1 and 2 will also need to be more powerful. Furthermore, since the motor gearbox unit of Joint 3 can interfere with Link 1 as discussed earlier, a larger motor will require the link designs to be modified in a way which will further increase the load on Joints 1 and 2. Also, the nominal output torque and velocity are the maximum output when the joint is generating both the torque and velocity output simultaneously. This will rarely occur in the exoskeleton since its usage will often involve low velocities when a high load is applied or vice versa. The chosen motor gearbox combination for Joint 3 is the best compromised solution after considering all the trade-offs.

16 Appendix B: Optimal 4R Mechanism Configurations 339 B.3 Sensors Angular position encoders pre-installed onto the motors are available, and this is a convenient option, however this cannot measure the angular displacement of the gearbox without knowing its position when the system starts up. Instead, absolute encoders are installed onto the exoskeleton joint to measure the angular displacement of the joint directly. This is achieved using AMS magnetic rotary encoders (AMS, Austria). These are high-resolution absolute encoders which measure a displacement angle relative to a pre-programmed zero position. Force measurement is achieved using custom-made force sensors comprising of RS strain gauges attached to a specially designed aluminium load structure. This is a low-cost alternative to the otherwise very expensive commercial force sensors. Each axis of force measurement uses a pair of strain gauges, one on each side of the load structure (Fig. B.7). A force applied to the end of the load structure causes it to bend resulting in compression of one strain gauge and extension of the other. This results in an increase in electrical resistance of the strain gauge under extension and a decrease in resistance for the strain gauge under compression. The use of a pair of Fig. B.7 Force sensing method. a Load specimen with no force applied. The Wheatstone bridge is balanced and the output voltage is zero. b Load specimen with force applied. The Wheatstone bridge is unbalanced and the output voltage is a function of the applied force

17 340 Appendix B: Optimal 4R Mechanism Configurations R Strain Gauge #1 V R Strain Gauge #2 Fig. B.8 A pair of strain gauges in a Wheatstone bridge in half-bridge configuration used in the force sensor strain gauges instead of one increases the sensitivity and compensates for changes in resistance due to temperature. The load structure is designed so that the strain gauges deform only when force is applied in the axis it is measuring and experience negligible deformation from force applied orthogonal to this axis. The pair of strain gauges is incorporated in a Wheatstone bridge circuit in half-bridge configuration (Fig. B.8). This circuit uses the change in resistance to generate an output voltage difference. This voltage difference is then amplified using an instrumentation amplifier and is converted to a noise-resistant digital signal using an I2C analog-to-digital converter (ADC).

18 Appendix C Supplementary Material on Robot Design Analysis This appendix contains additional information on the design analysis of the ankle rehabilitation robot. This includes the test conditions used to establish the maximum actuator force requirements. Additionally, it also provides a summary of additional results on workspace, singularity and force analysis for three linked designs with different parameters. C.1 Test Conditions for Force Analysis The actuator force requirement was computed for different designs based on application of different moments in different end effector configurations. Table C.1 provides a summary of configuration moment pairing considered in force analysis. Table C.1 Configuration moment pairings used in force analysis End effector orientation in XYZ Euler angles ( ) Applied moments along the Euler angle axes (Nm) h x h y h z s x s y s z ±100 ± ± ± ± ±100 ± ±100 ± ± ± ± ± ± ±40 Springer International Publishing Switzerland 2016 S.(S.Q.) Xie, Advanced Robotics for Medical Rehabilitation, Springer Tracts in Advanced Robotics 108, DOI /

19 342 Appendix C: Supplementary Material on Robot Design Analysis C.2 Simulation Parameters for MIMO Actuator Force Control Table C.2 provides a summary of the parameters used in the analysis and simulation of the MIMO actuator force controller. Table C.2 Parameters used in simulation and analysis of the MIMO actuator force controller Description Symbol Value/expression Motor rotational inertia J m 4: kg m 2 Motor viscous damping b m 2: Nm s/rad Motor torque constant K t 0:0365 Nm/A Belt stiffness k b N/m Belt viscous damping b b 5 N s/m Motor pulley radius r m 0:004 m Ball screw rotational inertia J s 1: kg m 2 Ball screw viscous damping b s Nm s/rad Ball screw pulley radius r s 0:02 m Ball screw transmission ratio G s 2p 0: rad=m Actuator rod mass m r 0:2kg Actuator rod viscous damping b r 0:05 N s/m Force sensor mass m f 0:2kg Force sensor stiffness k f N/m Force sensor damping b f 2500 N s/m Derivative gain K d 0:002 s Sampling time T 0:00075 s 2 Environmental inertia matrix at M e0 0: neutral position 4 0 0: kg m :04 Environmental damping matrix B e 0:1I 3 3 Nm s/rad 0:1I 3 3 þ 0:005K ankle Nm s/rad Environmental stiffness matrix K e 10I 3 3 Nm/rad K ankle Nm/rad Gain matrix in simulation K ½Um 0 v 0 diagð Þ½Um 0 v 0 ½Um 0 v 0 diagð Þ½Um 0 v 0 T T

20 Appendix C: Supplementary Material on Robot Design Analysis 343 C.3 Simulation Parameters for Assistance Adaptation Scheme This appendix provides the parameters used in the simulated case study to evaluate the efficacy of the different assistance adaptation scheme. Additionally, the simulation results and performance measures obtained from the passive-unconstrained, passive-constrained, active-unconstrained and active-constrained motion trials are also presented (Table C.3). Table C.3 Parameters used in the simulation case study for the proposed assistance adaptation scheme Description Symbol Value Rotational offset of environmental coordinates from robot/global coordinates U p 4 rad Stiffness along negative x-axis of environment coordinates k N/m Stiffness along positive x-axis of environment coordinates k N/m Stiffness along negative y-axis of environment coordinates k 3 25 N/m Stiffness along positive y-axis of environment coordinates k 4 25 N/m Zero potential boundary in negative X-direction of the u 01 0:1m environment coordinates Zero potential boundary in positive X-direction of the environment u 02 0:1m coordinates Zero potential boundary in negative Y-direction of the environment u 03 0:1m coordinates Zero potential boundary in positive Y-direction of the environment u 04 0:1m coordinates End effector mass m 1 kg Environmental viscous damping b env 5 N s/m Radius of circular reference trajectory r ref 0:7m Minor radius of elliptic kinematic constraint l a 0:2m Major radius of elliptic kinematic constraint l b 0:8m Rotational offset of semi-minor axis from positive x-axis of global frame u p 4 rad Stiffness of constraint boundary k con N/m Damping of constraint boundary b con 1000 N s/m

Cecilia Laschi The BioRobotics Institute Scuola Superiore Sant Anna, Pisa

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

More information

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

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

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

A Cost Oriented Humanoid Robot Motion Control System

A Cost Oriented Humanoid Robot Motion Control System Preprints of the 19th World Congress The International Federation of Automatic Control A Cost Oriented Humanoid Robot Motion Control System J. Baltes*, P. Kopacek**,M. Schörghuber** *Department of Computer

More information

Robotics. SAAST Robotics Robot Arms

Robotics. SAAST Robotics Robot Arms SAAST Robotics 008 Robot Arms Vijay Kumar Professor of Mechanical Engineering and Applied Mechanics and Professor of Computer and Information Science University of Pennsylvania Topics Types of robot arms

More information

Structural Configurations of Manipulators

Structural Configurations of Manipulators Structural Configurations of Manipulators 1 In this homework, I have given information about the basic structural configurations of the manipulators with the concerned illustrations. 1) The Manipulator

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

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

Articulated Robots! Robert Stengel! Robotics and Intelligent Systems! MAE 345, Princeton University, 2017

Articulated Robots! Robert Stengel! Robotics and Intelligent Systems! MAE 345, Princeton University, 2017 Articulated Robots! Robert Stengel! Robotics and Intelligent Systems! MAE 345, Princeton University, 2017 Robot configurations Joints and links Joint-link-joint transformations! Denavit-Hartenberg representation

More information

Chapter 5 Modeling and Simulation of Mechanism

Chapter 5 Modeling and Simulation of Mechanism Chapter 5 Modeling and Simulation of Mechanism In the present study, KED analysis of four bar planar mechanism using MATLAB program and ANSYS software has been carried out. The analysis has also been carried

More information

Exercise 2b: Model-based control of the ABB IRB 120

Exercise 2b: Model-based control of the ABB IRB 120 Exercise 2b: Model-based control of the ABB IRB 120 Prof. Marco Hutter Teaching Assistants: Vassilios Tsounis, Jan Carius, Ruben Grandia October 31, 2017 Abstract In this exercise you will learn how to

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

Documents. OpenSim Workshop. September 20-22, 2011 HYPER Summer School, La Alberca, Spain. Jeff Reinbolt, Jen Hicks. Website: SimTK.

Documents. OpenSim Workshop. September 20-22, 2011 HYPER Summer School, La Alberca, Spain. Jeff Reinbolt, Jen Hicks. Website: SimTK. Documents OpenSim Workshop September 20-22, 2011 HYPER Summer School, La Alberca, Spain Jeff Reinbolt, Jen Hicks Website: SimTK.org/home/opensim OpenSim Workshop Agenda 14:00 14:15 Welcome and goals of

More information

Kinematics. Kinematics analyzes the geometry of a manipulator, robot or machine motion. The essential concept is a position.

Kinematics. Kinematics analyzes the geometry of a manipulator, robot or machine motion. The essential concept is a position. Kinematics Kinematics analyzes the geometry of a manipulator, robot or machine motion. The essential concept is a position. 1/31 Statics deals with the forces and moments which are aplied on the mechanism

More information

Title: Active Preload Control of a Redundantly Actuated Stewart Platform for Backlash Prevention

Title: Active Preload Control of a Redundantly Actuated Stewart Platform for Backlash Prevention Elsevier Editorial System(tm) for Robotics and Computer Integrated Manufacturing Manuscript Draft Manuscript Number: Title: Active Preload Control of a Redundantly Actuated Stewart Platform for Backlash

More information

UNIVERSITY OF OSLO. Faculty of Mathematics and Natural Sciences

UNIVERSITY OF OSLO. Faculty of Mathematics and Natural Sciences Page 1 UNIVERSITY OF OSLO Faculty of Mathematics and Natural Sciences Exam in INF3480 Introduction to Robotics Day of exam: May 31 st 2010 Exam hours: 3 hours This examination paper consists of 5 page(s).

More information

Written exams of Robotics 2

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

More information

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

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

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

More information

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

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

Lecture VI: Constraints and Controllers. Parts Based on Erin Catto s Box2D Tutorial

Lecture VI: Constraints and Controllers. Parts Based on Erin Catto s Box2D Tutorial Lecture VI: Constraints and Controllers Parts Based on Erin Catto s Box2D Tutorial Motion Constraints In practice, no rigid body is free to move around on its own. Movement is constrained: wheels on a

More information

Optimization of a two-link Robotic Manipulator

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

More information

Table of Contents Introduction Historical Review of Robotic Orienting Devices Kinematic Position Analysis Instantaneous Kinematic Analysis

Table of Contents Introduction Historical Review of Robotic Orienting Devices Kinematic Position Analysis Instantaneous Kinematic Analysis Table of Contents 1 Introduction 1 1.1 Background in Robotics 1 1.2 Robot Mechanics 1 1.2.1 Manipulator Kinematics and Dynamics 2 1.3 Robot Architecture 4 1.4 Robotic Wrists 4 1.5 Origins of the Carpal

More information

ÉCOLE POLYTECHNIQUE DE MONTRÉAL

ÉCOLE POLYTECHNIQUE DE MONTRÉAL ÉCOLE POLYTECHNIQUE DE MONTRÉAL MODELIZATION OF A 3-PSP 3-DOF PARALLEL MANIPULATOR USED AS FLIGHT SIMULATOR MOVING SEAT. MASTER IN ENGINEERING PROJET III MEC693 SUBMITTED TO: Luc Baron Ph.D. Mechanical

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

Chapter 1 Introduction

Chapter 1 Introduction Chapter 1 Introduction Generally all considerations in the force analysis of mechanisms, whether static or dynamic, the links are assumed to be rigid. The complexity of the mathematical analysis of mechanisms

More information

n Measuring range 0... ± 0,02 Nm to 0... ± 1000 Nm n Low linearity deviation of ± 0.05 % F.S. n Intelligent operating state indicator

n Measuring range 0... ± 0,02 Nm to 0... ± 1000 Nm n Low linearity deviation of ± 0.05 % F.S. n Intelligent operating state indicator Precision Torque Sensor Non-contact transmission for rotating applications Optional measurement of angle and speed Model 8661 Code: Delivery: Warranty: 2-3 weeks 24 months Optional: USB interface Dual

More information

Exercise 2b: Model-based control of the ABB IRB 120

Exercise 2b: Model-based control of the ABB IRB 120 Exercise 2b: Model-based control of the ABB IRB 120 Prof. Marco Hutter Teaching Assistants: Vassilios Tsounis, Jan Carius, Ruben Grandia October 31, 2017 Abstract In this exercise you will learn how to

More information

Robotics (Kinematics) Winter 1393 Bonab University

Robotics (Kinematics) Winter 1393 Bonab University Robotics () Winter 1393 Bonab University : most basic study of how mechanical systems behave Introduction Need to understand the mechanical behavior for: Design Control Both: Manipulators, Mobile Robots

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

Clearpath Communication Protocol. For use with the Clearpath Robotics research platforms

Clearpath Communication Protocol. For use with the Clearpath Robotics research platforms Clearpath Communication Protocol For use with the Clearpath Robotics research platforms Version: 1.1 Date: 2 September 2010 Revision History Version Date Description 1.0 26 March 2010 Release 1.1 2 September

More information

Flexible Modeling and Simulation Architecture for Haptic Control of Maritime Cranes and Robotic Arms

Flexible Modeling and Simulation Architecture for Haptic Control of Maritime Cranes and Robotic Arms Flexible Modeling and Simulation Architecture for Haptic Control of Maritime Cranes and Robotic Arms F. Sanfilippo, H. P. Hildre, V. Æsøy and H.X. Zhang Department of Maritime Technology and Operation

More information

Stress Analysis of Cross Groove Type Constant Velocity Joint

Stress Analysis of Cross Groove Type Constant Velocity Joint TECHNICAL REPORT Stress Analysis of Cross Groove Type Constant Velocity Joint H. SAITO T. MAEDA The driveshaft is the part that transmits the vehicle's engine torque and rotation to the tires, and predicting

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

Written exams of Robotics 1

Written exams of Robotics 1 Written exams of Robotics 1 http://www.diag.uniroma1.it/~deluca/rob1_en.php All materials are in English, unless indicated (oldies are in Year Date (mm.dd) Number of exercises Topics 2018 06.11 2 Planar

More information

13. Learning Ballistic Movementsof a Robot Arm 212

13. Learning Ballistic Movementsof a Robot Arm 212 13. Learning Ballistic Movementsof a Robot Arm 212 13. LEARNING BALLISTIC MOVEMENTS OF A ROBOT ARM 13.1 Problem and Model Approach After a sufficiently long training phase, the network described in the

More information

CHAPTER 3 MATHEMATICAL MODEL

CHAPTER 3 MATHEMATICAL MODEL 38 CHAPTER 3 MATHEMATICAL MODEL 3.1 KINEMATIC MODEL 3.1.1 Introduction The kinematic model of a mobile robot, represented by a set of equations, allows estimation of the robot s evolution on its trajectory,

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

Assignment 3: Robot Design and Dynamics ME 328: Medical Robotics Stanford University w Autumn 2016

Assignment 3: Robot Design and Dynamics ME 328: Medical Robotics Stanford University w Autumn 2016 Assignment 3: Robot Design and Dynamics ME 328: Medical Robotics Stanford University w Autumn 2016 Due to submission box outside Okamura s office by :00 pm on Monday, October 2 (revised) Note: You can

More information

The Collision-free Workspace of the Tripteron Parallel Robot Based on a Geometrical Approach

The Collision-free Workspace of the Tripteron Parallel Robot Based on a Geometrical Approach The Collision-free Workspace of the Tripteron Parallel Robot Based on a Geometrical Approach Z. Anvari 1, P. Ataei 2 and M. Tale Masouleh 3 1,2 Human-Robot Interaction Laboratory, University of Tehran

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

Connection Elements and Connection Library

Connection Elements and Connection Library Connection Elements and Connection Library Lecture 2 L2.2 Overview Introduction Defining Connector Elements Understanding Connector Sections Understanding Connection Types Understanding Connector Local

More information

Mechanical Design Challenges for Collaborative Robots

Mechanical Design Challenges for Collaborative Robots Motor Technologies Mechanical Design Challenges for Collaborative Robots TN-3301 REV 170526 THE CHALLENGE Robotics and additive manufacturing markets have entered into a new phase of growth. This growth

More information

Selection of controllers and integrated systems

Selection of controllers and integrated systems maxon motor: Selection of controllers and integrated systems 2017 maxon motor ag maxon_control-system-selection, WJ, Animated Version V2.31 Criteria to find the base drive controller family Base criteria

More information

Applications. Systems. Motion capture pipeline. Biomechanical analysis. Graphics research

Applications. Systems. Motion capture pipeline. Biomechanical analysis. Graphics research Motion capture Applications Systems Motion capture pipeline Biomechanical analysis Graphics research Applications Computer animation Biomechanics Robotics Cinema Video games Anthropology What is captured?

More information

Mechanical, analog system comprising sensor and processor for accurately recording the position of gripper jaws.

Mechanical, analog system comprising sensor and processor for accurately recording the position of gripper jaws. APS-M1 Accessories Sensor System Analog Position Sensor Analog Position Sensor System Mechanical, analog system comprising sensor and processor for accurately recording the position of gripper jaws. Function

More information

Computer Animation and Visualisation. Lecture 3. Motion capture and physically-based animation of characters

Computer Animation and Visualisation. Lecture 3. Motion capture and physically-based animation of characters Computer Animation and Visualisation Lecture 3. Motion capture and physically-based animation of characters Character Animation There are three methods Create them manually Use real human / animal motions

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

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

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

More information

Time-Invariant Strategies in Coordination of Human Reaching

Time-Invariant Strategies in Coordination of Human Reaching Time-Invariant Strategies in Coordination of Human Reaching Satyajit Ambike and James P. Schmiedeler Department of Mechanical Engineering, The Ohio State University, Columbus, OH 43210, U.S.A., e-mail:

More information

ROBOT SENSORS. 1. Proprioceptors

ROBOT SENSORS. 1. Proprioceptors ROBOT SENSORS Since the action capability is physically interacting with the environment, two types of sensors have to be used in any robotic system: - proprioceptors for the measurement of the robot s

More information

ECS servo system MCS servo motors

ECS servo system MCS servo motors ECS servo system MCS servo motors for multi-axis applications Lenze Global Drive dynamic, powerful, compact ECS, MCS dynamic, powerful, compact The ECS servo system Servo drives with a high overload capacity

More information

Innovations in touch-trigger probe sensor technology

Innovations in touch-trigger probe sensor technology White paper Innovations in touch-trigger probe sensor technology Abstract Since the invention of the touch-trigger probe in the 1970s, these devices have formed the main means of sensing for dimensional

More information

MECHATRONICS SYSTEM ENGINEERING FOR CAE/CAD, MOTION CONTROL AND DESIGN OF VANE ACTUATORS FOR WATER ROBOT APPLICATIONS

MECHATRONICS SYSTEM ENGINEERING FOR CAE/CAD, MOTION CONTROL AND DESIGN OF VANE ACTUATORS FOR WATER ROBOT APPLICATIONS MECHATRONICS SYSTEM ENGINEERING FOR CAE/CAD, MOTION CONTROL AND DESIGN OF VANE ACTUATORS FOR WATER ROBOT APPLICATIONS Finn CONRAD and Francesco ROLI Department of Mechanical Engineering, Technical University

More information

Lecture VI: Constraints and Controllers

Lecture VI: Constraints and Controllers Lecture VI: Constraints and Controllers Motion Constraints In practice, no rigid body is free to move around on its own. Movement is constrained: wheels on a chair human body parts trigger of a gun opening

More information

HEXAPODS FOR PRECISION MOTION AND VIBRATION CONTROL

HEXAPODS FOR PRECISION MOTION AND VIBRATION CONTROL HEXAPODS FOR PRECISION MOTION AND VIBRATION CONTROL Eric H. Anderson, Michael F. Cash, Jonathan L. Hall and Gregory W. Pettit CSA Engineering Inc., Mountain View, CA Introduction Parallel kinematic manipulators

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

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

DYNAMICS OF SPACE ROBOTIC ARM DURING INTERACTIONS WITH NON COOPERATIVE OBJECTS

DYNAMICS OF SPACE ROBOTIC ARM DURING INTERACTIONS WITH NON COOPERATIVE OBJECTS DYNAMICS OF SPACE ROBOTIC ARM DURING INTERACTIONS WITH NON COOPERATIVE OBJECTS Karol Seweryn 1, Marek Banaszkiewicz 1, Bernd Maediger 2, Tomasz Rybus 1, Josef Sommer 2 1 Space Research Centre of the Polish

More information

ROBOTICS 01PEEQW. Basilio Bona DAUIN Politecnico di Torino

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

More information

Manipulator Path Control : Path Planning, Dynamic Trajectory and Control Analysis

Manipulator Path Control : Path Planning, Dynamic Trajectory and Control Analysis Manipulator Path Control : Path Planning, Dynamic Trajectory and Control Analysis Motion planning for industrial manipulators is a challenging task when obstacles are present in the workspace so that collision-free

More information

Interfacing OpenSim models with MATLAB /Simulink. OpenSim Workshop

Interfacing OpenSim models with MATLAB /Simulink. OpenSim Workshop Interfacing OpenSim models with MATLAB /Simulink Acknowledgements Why do we care about MATLAB and OpenSim? MATLAB Simulink S- func5on OpenSim Pros World s leading mathematical computing software Used by

More information

ROSE-HULMAN INSTITUTE OF TECHNOLOGY

ROSE-HULMAN INSTITUTE OF TECHNOLOGY Introduction to Working Model Welcome to Working Model! What is Working Model? It's an advanced 2-dimensional motion simulation package with sophisticated editing capabilities. It allows you to build and

More information

Bus Capable. Compact. Flexible. WSG Intelligent Gripper

Bus Capable. Compact. Flexible. WSG Intelligent Gripper WSG Bus Capable. Compact. Flexible. WSG Intelligent Gripper Servo-electric 2-finger parallel gripper with highly precise gripping force control and long stroke Field of Application A ll-purpose, ultra-flexible

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

Kinematics of Machines. Brown Hills College of Engineering & Technology

Kinematics of Machines. Brown Hills College of Engineering & Technology Introduction: mechanism and machines, kinematic links, kinematic pairs, kinematic chains, plane and space mechanism, kinematic inversion, equivalent linkages, four link planar mechanisms, mobility and

More information

DESIGN AND VERIFICATION OF THE TRINANO ULTRA PRECISION CMM

DESIGN AND VERIFICATION OF THE TRINANO ULTRA PRECISION CMM URN (Paper): urn:nbn:de:gbv:ilm1-2011iwk-092:8 56 TH INTERNATIONAL SCIENTIFIC COLLOQUIUM Ilmenau University of Technology, 12 16 September 2011 URN: urn:nbn:gbv:ilm1-2011iwk:5 DESIGN AND VERIFICATION OF

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

Robots are built to accomplish complex and difficult tasks that require highly non-linear motions.

Robots are built to accomplish complex and difficult tasks that require highly non-linear motions. Path and Trajectory specification Robots are built to accomplish complex and difficult tasks that require highly non-linear motions. Specifying the desired motion to achieve a specified goal is often a

More information

Cylinders in Vs An optomechanical methodology Yuming Shen Tutorial for Opti521 November, 2006

Cylinders in Vs An optomechanical methodology Yuming Shen Tutorial for Opti521 November, 2006 Cylinders in Vs An optomechanical methodology Yuming Shen Tutorial for Opti521 November, 2006 Introduction For rotationally symmetric optical components, a convenient optomechanical approach which is usually

More information

Industrial Robots : Manipulators, Kinematics, Dynamics

Industrial Robots : Manipulators, Kinematics, Dynamics Industrial Robots : Manipulators, Kinematics, Dynamics z z y x z y x z y y x x In Industrial terms Robot Manipulators The study of robot manipulators involves dealing with the positions and orientations

More information

INDUSTRIAL INCLINOMETER ANALOG & RS232 INTERFACE

INDUSTRIAL INCLINOMETER ANALOG & RS232 INTERFACE The industrial inclinometers are compact solutions for determining the inclination in both single and dual axes with remarkable precision and at a lower expense. The molded housing provides the mechanical

More information

ANNALS of Faculty Engineering Hunedoara International Journal of Engineering

ANNALS of Faculty Engineering Hunedoara International Journal of Engineering ANNALS of Faculty Engineering Hunedoara International Journal of Engineering Tome XIII [05] Fascicule [February] ISSN: 58-665 [print]; ISSN: 58-67 [online] a free-access multidisciplinary publication of

More information

September 20, Chapter 5. Simple Mechanisms. Mohammad Suliman Abuhaiba, Ph.D., PE

September 20, Chapter 5. Simple Mechanisms. Mohammad Suliman Abuhaiba, Ph.D., PE Chapter 5 Simple Mechanisms 1 Mohammad Suliman Abuhaiba, Ph.D., PE 2 Assignment #1 All questions at the end of chapter 1 st Exam: Saturday 29/9/2018 3 Kinematic Link or Element kinematic link (link) or

More information

which is shown in Fig We can also show that the plain old Puma cannot reach the point we specified

which is shown in Fig We can also show that the plain old Puma cannot reach the point we specified 152 Fig. 7.8. Redundant manipulator P8 >> T = transl(0.5, 1.0, 0.7) * rpy2tr(0, 3*pi/4, 0); The required joint coordinates are >> qi = p8.ikine(t) qi = -0.3032 1.0168 0.1669-0.4908-0.6995-0.1276-1.1758

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

ELEC 341 Project Selective Laser Sintering 3D Printer The University of British Columbia

ELEC 341 Project Selective Laser Sintering 3D Printer The University of British Columbia ELEC 341 Project 2017 - Selective Laser Sintering 3D Printer The University of British Columbia In selective laser sintering (SLS), 3D parts are built by spreading a thin layer of metallic powder over

More information

Active Preload Control of a Redundantly Actuated Stewart Platform for Backlash Prevention

Active Preload Control of a Redundantly Actuated Stewart Platform for Backlash Prevention Active Preload Control of a Redundantly Actuated Stewart Platform for Backlash Prevention Boyin Ding, Benjamin S. Cazzolato, Steven Grainger, Richard M. Stanley, and John J. Costi Abstract There is an

More information

EEE 187: Robotics Summary 2

EEE 187: Robotics Summary 2 1 EEE 187: Robotics Summary 2 09/05/2017 Robotic system components A robotic system has three major components: Actuators: the muscles of the robot Sensors: provide information about the environment and

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

INPUT PARAMETERS FOR MODELS I

INPUT PARAMETERS FOR MODELS I 9A-1 INPUT PARAMETERS FOR MODELS I Lecture Overview Equations of motion Estimation of muscle forces Required model parameters Body segment inertial parameters Muscle moment arms and length Osteometric

More information

Meeting Date: February 12, Meeting Location: Building 78 Room Meeting time: 8:00 10:00 AM. Timeline:

Meeting Date: February 12, Meeting Location: Building 78 Room Meeting time: 8:00 10:00 AM. Timeline: Agenda Meeting Purpose Detailed design review of P10543 Update of color measurement system. The objective of this technical review is to conduct an evaluation of the proposed design solution and to identify

More information

MDP646: ROBOTICS ENGINEERING. Mechanical Design & Production Department Faculty of Engineering Cairo University Egypt. Prof. Said M.

MDP646: ROBOTICS ENGINEERING. Mechanical Design & Production Department Faculty of Engineering Cairo University Egypt. Prof. Said M. MDP646: ROBOTICS ENGINEERING Mechanical Design & Production Department Faculty of Engineering Cairo University Egypt Prof. Said M. Megahed APPENDIX A: PROBLEM SETS AND PROJECTS Problem Set # Due 3 rd week

More information

Modeling and kinematics simulation of freestyle skiing robot

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

More information

Human Motion. Session Speaker Dr. M. D. Deshpande. AML2506 Biomechanics and Flow Simulation PEMP-AML2506

Human Motion. Session Speaker Dr. M. D. Deshpande. AML2506 Biomechanics and Flow Simulation PEMP-AML2506 AML2506 Biomechanics and Flow Simulation Day 02A Kinematic Concepts for Analyzing Human Motion Session Speaker Dr. M. D. Deshpande 1 Session Objectives At the end of this session the delegate would have

More information

SUPPORTING LINEAR MOTION: A COMPLETE GUIDE TO IMPLEMENTING DYNAMIC LOAD SUPPORT FOR LINEAR MOTION SYSTEMS

SUPPORTING LINEAR MOTION: A COMPLETE GUIDE TO IMPLEMENTING DYNAMIC LOAD SUPPORT FOR LINEAR MOTION SYSTEMS SUPPORTING LINEAR MOTION: A COMPLETE GUIDE TO IMPLEMENTING DYNAMIC LOAD SUPPORT FOR LINEAR MOTION SYSTEMS Released by: Keith Knight Catalyst Motion Group Engineering Team Members info@catalystmotiongroup.com

More information

Trajectory Tracking Control of A 2-DOF Robot Arm Using Neural Networks

Trajectory Tracking Control of A 2-DOF Robot Arm Using Neural Networks The Islamic University of Gaza Scientific Research& Graduate Studies Affairs Faculty of Engineering Electrical Engineering Depart. الجبمعت اإلسالميت غزة شئىن البحث العلمي و الدراسبث العليب كليت الهندست

More information

Compound Movements in Multi-joint Systems

Compound Movements in Multi-joint Systems Compound movements in multi-joint systems almost never have a fixed center of rotation, with no translation In fact, the principal advantage of compound movements is often that they convert rotations into

More information

There is no need to submit any report and you just need to finish the three tutorials as well as the example.

There is no need to submit any report and you just need to finish the three tutorials as well as the example. The first three tutorials are selected from the MATLAB/Simulink help. The fourth example is a simple SimMechanics example which can help you learn the SimMechanics more. You can find more detailed information

More information

Theory of Machines Course # 1

Theory of Machines Course # 1 Theory of Machines Course # 1 Ayman Nada Assistant Professor Jazan University, KSA. arobust@tedata.net.eg March 29, 2010 ii Sucess is not coming in a day 1 2 Chapter 1 INTRODUCTION 1.1 Introduction Mechanisms

More information

Single Linear Flexible Joint (SLFJ)

Single Linear Flexible Joint (SLFJ) Linear Motion Servo Plants: IP01 and IP02 Single Linear Flexible Joint (SLFJ) User Manual Table of Contents 1. Single Linear Flexible Joint (SLFJ)...1 1.1. Single Linear Flexible Joint: System Description...1

More information

Exam in DD2426 Robotics and Autonomous Systems

Exam in DD2426 Robotics and Autonomous Systems Exam in DD2426 Robotics and Autonomous Systems Lecturer: Patric Jensfelt KTH, March 16, 2010, 9-12 No aids are allowed on the exam, i.e. no notes, no books, no calculators, etc. You need a minimum of 20

More information

Design and Analysis of Voice Activated Robotic Arm

Design and Analysis of Voice Activated Robotic Arm Design and Analysis of Voice Activated Robotic Arm Ajay Aravind S4 MTECH Government College of Engineering, Kannur ajayaravind05@gmail.com Dr. T.D. John PROFESSOR Government Engineering College, Kannur

More information

5-Axis Flex Track Drilling Systems on Complex Contours: Solutions for Position Control

5-Axis Flex Track Drilling Systems on Complex Contours: Solutions for Position Control 5-Axis Flex Track Drilling Systems on Complex Contours: Solutions for Position Control 2013-01-2224 Published 09/17/2013 Joseph R. Malcomb Electroimpact Inc. Copyright 2013 SAE International doi:10.4271/2013-01-2224

More information

MACHINES AND MECHANISMS

MACHINES AND MECHANISMS MACHINES AND MECHANISMS APPLIED KINEMATIC ANALYSIS Fourth Edition David H. Myszka University of Dayton PEARSON ж rentice Hall Pearson Education International Boston Columbus Indianapolis New York San Francisco

More information

Camera gimbal control system for unmanned platforms

Camera gimbal control system for unmanned platforms 8 th International Symposium Topical Problems in the Field of Electrical and Power Engineering Pärnu, Estonia, January 11-16, 2010 Camera gimbal control system for unmanned platforms Kristjan Tiimus, Mart

More information

Proceedings of the 2013 SpaceVision Conference November 7-10 th, Tempe, AZ, USA ABSTRACT

Proceedings of the 2013 SpaceVision Conference November 7-10 th, Tempe, AZ, USA ABSTRACT Proceedings of the 2013 SpaceVision Conference November 7-10 th, Tempe, AZ, USA Development of arm controller for robotic satellite servicing demonstrations Kristina Monakhova University at Buffalo, the

More information

Dynamic Simulation of a KUKA KR5 Industrial Robot using MATLAB SimMechanics

Dynamic Simulation of a KUKA KR5 Industrial Robot using MATLAB SimMechanics Dynamic Simulation of a KUKA KR5 Industrial Robot using MATLAB SimMechanics Arun Dayal Udai, C.G Rajeevlochana, Subir Kumar Saha Abstract The paper discusses a method for the dynamic simulation of a KUKA

More information