BALL ON PLATE BALANCING SYSTEM Proposal for ECSE-4962 Control Systems Design

Size: px
Start display at page:

Download "BALL ON PLATE BALANCING SYSTEM Proposal for ECSE-4962 Control Systems Design"

Transcription

1 BALL ON PLATE BALANCING SYSTEM Proposal for ECSE-4962 Control Systems Design Greg Andrews Chris Colasuonno Aaron Herrmann February 18, 2004 Rensselaer Polytechnic Institute

2 Abstract This report describes the proposed design and development strategy for implementing a control system to balance a ball on a plate. A pan-tilt device is placed on its side so as to create a tilt-tilt mechanism capable of moving a ball within an X-Y plane. A resistive touch pad is placed on the plane to allow the measurement of the location of said ball. Dynamic modeling of this system allows the creation of a digital controller capable of placing the ball at certain locations or following a preset path. The project goal is to create a system capable of moving the ball at a rapid rate of speed in any of several predefined complex paths with precision and accuracy.

3 Contents 1 Introduction 4 2 Objective 5 3 Design Strategy Model Development Performance Specifications vs. Available Components Parameter Identification Simulation Controller Design and Tuning Design Alternatives Subsystem Development Touch pad Inclinometer Verification Testing Procedure Tolerance Analysis Cost and Schedule Cost Analysis Phases Schedule Statement of Contribution 20 A Touch pad data sheet 22 B Coordinate System - Body A 24 C Coordinate System - Body B 25 D CAD Model 26 1

4 List of Figures 3.1 System States System States with Initial Conditions Simulation Diagram for Ball Dynamics Ball States

5 List of Tables 3.1 Arbitrary Friction Values Touchpad Pinout List of parts List of raw materials Labor costs Schedule

6 Chapter 1 Introduction The goal of this project is to develop a ball-on-plate balancing system, capable of controlling the position of a ball on a plate for both static positions as well as smooth paths. We intend that the initially horizontal plate will be tilted along each of two horizontal axes in order to control the position of the ball. Each tilting axis will be operated on by an electric motor. Each motor will be controlled using software, with a minimum of position feedback for control. After an extensive search, few systems of similar scale were found. The ball-on-beam system, a 1-dimensional similarity to the ball-on-plate, however, is a classic control problem, and has been studied in great detail, and solved a great many ways; PID control, optimal control, fuzzy-logic controllers, etc. The fuzzy-logic controllers would seem to be the current state of the art, however classical approaches using discrete approximations are certainly adequate, if not preferred for their relative ease of implementation. Two ball-on-plate systems were uncovered during the search: one, developed at Rensselaer Polytechnic Institute by Professor Kevin Craig [3] using a similar method to that which we intend, and another at the University of Newcastle, Australia, which was developed using image processing techniques in conjunction with a textbook by Professors Graham Goodwin, Stefan Graebe and Mario Salgado [4]. While this would seem to be a short list, the ball and beam system seems to be a more popular and less structurally complex system to implement. The aim of this project will be to create a ball-plate system using a resistive touch sensor to allow the movement of a ball by means of automatic control. The system should have accuracy of < 2% in the placement of the ball on the screen, as well as the ability to move the ball from one end of the plate to the other in less than 2 seconds (long side). Overshoot should be minimal, to reduce the chances of losing the ball off of the plate or incurring damage to the touch element due to striking the physical structure of the system. 4

7 Chapter 2 Objective The goal of the ball-plate system will be to initially create a system that can hold a ball in a static position on the plate. From there, the goal will then be to be able to move the ball around the plate in varying defined motion paths. The system should also be able to compensate for disturbances in the intended motion path of the ball, as well as disturbances to the physical support system. Initially, the desire of the team was to design a control system that could traverse a maze using the ball-plate system, using image processing to view the maze and plot a solution. However, given the processing power and estimation inherent to image processing techniques, as well as the team s lack of experience with the theory behind these techniques, this was abandoned. The traversal of a maze might still be possible, however, the traversal would be based on a known set of moves, as opposed to an on-the-fly calculation. Several challenges in the design and construction of this system can be foreseen. In order to construct the physical system, it will be necessary to machine several metal parts. A method of keeping the ball on the plate rolling when in motion rather than sliding is also necessary. A rubber membrane is on order to cover the touch pad with a frictional surface. However, the thickness of this membrane will also affect the sensitivity of the touch pad and therefore the necessary mass of the steel ball will need to be large, mandating a ball of large proportions. Gathering position data from the touch pad will also provide an added challenge. A serial interface controller is included with the kit, however additional precision is needed for our application, so we will have the added chore of developing a system to drive and sample the touch pad in order to generate the X-Y coordinates required. Finally, the control problem itself will be a significant challenge. Currently we intend to design the system as two uncoupled links, yet there may in truth be greater than negligible nonlinearities and coupling effects between the links. In addition, designing the system using a full state-feedback control system or a linearquadratic state-feedback regulator (LQR) will be far more complicated than simple PID control. 5

8 Chapter 3 Design Strategy 3.1 Model Development Due to the complexity of this system, a highly accurate, non-linear model must be developed. In order to consider a Lagrange-Euler dynamic model, the kinetic and potential energies of the system must be found. The kinetic energy is comprised of the energy due to both the linear and angular motion of the system, and can be represented as an inertia tensor. Gravity, friction, and velocity coupling terms must also be considered to represent the full non-linear dynamic model. Professor Wen s pantilt.m script was used to define the symbolic equations of motion for our system. In this file, the gravity vector had to be changed to point in the negative-x direction to account for our system s orientation change. This script returned symbolic values for the inertia tensor, velocity coupling matrix, gravity loading vector, and total energy. As expected, the gravity loading vector contained a term for the pan axis due to our orientation. Based on a Solidworks model of our system, the inertia tensors for bodies A and B with respect to the defined output coordinate systems as shown in Figures B and C were found to be: I a = I b = (3.1) Solidworks also provided the total mass of the bodies. Since the equations of motion were left in symbolic form, values for inertia, mass, and other parameters can be easily changed. In addition to these equations of motion for bodies for bodies A and B, a model must be developed for the ball itself, body C. In Professor Craig s previous work in the Mechatronics department here at RPI, equations of motion for the ball based on the platform angles were developed. Based on the small angle assumption made, Eqs. (3) and (4) in [3], should hold true for our system. This provides us with equations of motion for the ball in non-linear form. For now, the non-linear model will be considered, however Professor Craig s 6

9 system was linearized to decouple the two modes of motion. See Eq. (5) in [3]. The inertia of the ball was found for the equation of inertia for a solid sphere[5]. I c = 2 5 m cr 2 b 3.2 Performance Specifications vs. Available Components Beginning with the physical specifications of the desired system, quickly we see that we require several simple parts that are unavailable from the set of components with which we have been provided. In order to construct the system, several metal parts need to be machined in order to accommodate the 10.4 inch touch-screen platform. These parts include a new yoke, motor mount plate, and specialized shaft. The yoke and mount plate are much larger than those originally provided, and material has been removed from a larger diameter shaft in order to position the platform at the center of the axis of rotation. The overall weight of the final system will be approximately 1.2 kg. These parts can all be seen in the cad model in Figure D. High torque, high speed motors will be employed in the system. They are a necessary result of the combination of several factors. The system will be fairly heavy and a large gravity loading will be placed upon each motor, especially the base tilt axis which will support the entire system. The plate will tilt over a ±35 range in one second and thus fairly fasts speeds will be required. These speeds will be necessary to accurately control the ball s path with any amount of reasonable speed. It is expected that the motors will be required to rotate at speeds of at least 1.35 radians/sec. High resolution optical encoders will also be employed in the system. In order to control the motion of the ball with precision, a decent value for velocity feedback will be required. However, since the touch pad and encoders will only provide position feedback, it will be necessary to integrate the position to find velocity. Making use of optical encoders with a high resolution will help ensure greater accuracy and less noise in this integration. The encoders have a resolution of 2048 levels, with quadrature and our A/D converters we can achieve an effective resolution of 4096 levels. A rubber membrane of 1/16 thickness will be applied to the contact surface of the touch-screen. This membrane will serve to provide the friction necessary for the ball to roll rather than slide on the surface while remaining thin enough as to not greatly increase the weight of the ball which will be necessary to read position information from the touch-screen. A steel ball bearing of 1.25 diameter and weighing in at approximately 130 grams will serve as the ball in the system. This should provide sufficient weight to cause a response in the touch-screen setup. If after experimentation it can be determined that this is excessive, a smaller ball may be substituted. The touch-screen itself that will be used to detect the position of the ball on the surface is a 10.4 diagonal Dynapro wire resistive touch pad. The screen s total outside dimensions can be seen on the attached cad drawing. Rather than using the supplied serial encoder, we intend to interface directly with the screen, performing A/D conversions on the read lines in order to determine the position of the ball on the surface. The screen will also have a resolution of 4096 levels, due to the 12-bit A/D converters on the interface computer. 7

10 It will be necessary to keep noise at a minimum by making clean connections and perhaps shielding wires. The touch-screen operates in an analog fashion over only on a 0-3v range. Any significant noise could lead to inaccurate reading of the position of the ball which would severely limit the accuracy and precision of the final system. 3.3 Parameter Identification Once the system has been constructed, it will be necessary to identify physical parameters of the system such as friction and gravity loading. Friction will occur within the system at various locations such as motor, gear, and joint bearings as well as on the belts and pulleys, however if properly identified this friction can be canceled. Coulomb friction, which is constant when an object is moving, and viscous friction, which is proportional to velocity, will be lumped together as one friction term and determined experimentally. A Simulink diagram capable of outputting constant voltages and measuring the encoders will be used to repeatedly estimate joint velocity. A MATLAB script is being written to automate this process so that multiple trials may be easily run and averaged to get the best approximation of the friction parameter. It should be noted however that this measurement will be limited by the fact that velocity is being estimated. Any variance from the actual friction measurement will have to be considered a disturbance. 3.4 Simulation Based on Ben Potsaid s Laser Pointer Demo, a simulation has been developed to test the validity of our developed model. The simulation is initialized with our numerical values with the pantiltinit.m script attached to this proposal. The first step in simulation was to check conservation of energy. After disabling gravity, friction, and torque input, the simulation was run, and energy was plotted vs. time. The energy was calculated based on the equations returned from Professor Wen s pantilt.m script for our system. Energy is indeed conserved (remains at a constant 0 value for all time), as would be expected. The next step was to enable gravity and friction, and run the simulation. Chosen values for friction are shown in Table 3.1. As Table 3.1: Arbitrary Friction Values Joint Viscous Coulomb Pan Tilt expected, the pan axis swings down, and settles to a final value because of the gravity loading as seen in Figure 3.1. In addition to this, a small movement is noticed in the tilt axis presumably due to the velocity coupling between the axes. When initial conditions for the pan axis are 2.1rad, the pan axis swings in the other direction, finally reaching the original settling point. This is as expected since at this point, the motor crosses vertical plane formed by the pan axis. See Figure 3.2. Using the equations of motion from Professor Craig s [3] paper, the ball dynamics have been implemented 8

11 Figure 3.1: System States Figure 3.2: System States with Initial Conditions 9

12 into the simulation. From the equations, we can solve for ẍ and ÿ in terms of the state variables: [ ] u = θ1 θ2 θ 1 θ 2 θ 1 θ 2 ẋ ẏ x y (3.2) To do this, initial conditions are given to ẋ, ẏ, x, and y. Then, ẍ and ÿ are calculated and integrated to find x and y. A simulation diagram is given in Figure 3.3. More simulation needs to be done to test the validity of this model, however some simple simulations have been run. To test, gravity was removed from the base system, but kept on the ball. The plate was given an initial condition in one direction of 0.1rad. As expected, the ball accelerates in one direction, as seen in Figure 3.4. Figure 3.3: Simulation Diagram for Ball Dynamics Figure 3.4: Ball States 10

13 3.5 Controller Design and Tuning Based on the simulation that we are currently developing, a control system can be developed. As noted in Chapter 5, different controllers are planed to be developed depending on our success in each phase. Initially, we aim simply to balance the ball on the plate. This can be achieved with a traditional PID controller through root-locus and frequency-response analysis. Upon successful completion of this phase, a more sophisticated controller will be designed to allow us to accurately control the position of the ball on the plate and reject disturbances. To do this, we plan on implementing a full state-feedback controller. For our system, the state vector would be of the form: [ x := θ 1 θ 2 θ 1 θ 2 x b y b x b ] T y b (3.3) Since our model is in a non-linear form, the system must be linearized about an operating point [6] (θ, θ) = (θ d, 0). Another more advanced technique we may pursue upon completion of the former controller is to implement a linear-quadratic state-feedback regulator (LQR). To obtain higher accuracy, the system will be linearized around a number of operating points corresponding to different variations of θ and θ. Gains will be calculated off-line for the LQR at each operating point, and stored in a look-up-table. A simple interpolation function will determine the gains for intermediate states. This will allow the controller to respond quickly since all gains are calculated off-line, and state variables should be optimally controlled. An additional approach may be to implement an observer design. Since velocity cannot be directly measured, finite difference and/or washout filter methods would normally be used to estimate velocity from position measurements. However, these methods often produce unwanted noise. A possible solution to this would be to implement an observer to estimate the velocity: ˆx(k + 1) = Aˆx(k) + Bu(k) + L(y(k) ŷ(k)) (3.4) ŷ(k) + C ˆx(k) where L in Eq. 3.4 represents a column vector designed to cause the observer error e(k) := ˆx(k) x(k) to converge to zero [2]. 3.6 Design Alternatives Several control design alternatives are currently being contemplated in an attempt to achieve optimum performance from the system. Initially, PID control will be utilized using a linearized model in order to achieve an initial working system with which to further develop other systems. However, due to the nonlinear nature of the system, its inherent unbalanced state, and the complexity of the feedback system, it is expected that in order to achieve the desired performance specifications and a high degree of accuracy, a state-feedback controller will be required. Several designs will need to be developed and compared, however. Working with MATLAB Simulink, a script will be created to run each control design through a specified set of maneuvers: simple plate motions, static ball balancing, and ball path following. After the completion of the runs, graphs of the actual motions and states of the system can be compared to analyze overshoot, response time, and overall accuracy and performance. 11

14 3.7 Subsystem Development Touch pad The touch pad is the key piece to achieving our objective of balancing a ball on a plate. The touch pad we will use is a resistive element, returning an analog voltage corresponding to the location of the pressure applied to it. The pad is an 8-wire panel, but it needs to be pulsed in order to retrieve location information. Each axis needs to be pulsed separately, and the analog voltage read off a single pin. This pin diagram is show in Table 3.2 [1]. The touch pad as received came with a serial (RS-232) interface controller card capable of controlling the touch pad and retrieving data points from it. Our concern, however, is the accuracy of the controller, as well as the difficulty in using it with the MATLAB xpc target software. The controller uses a Texas Instruments 10-bit A/D converter, and the concern is that the resolution of 1024x1024 capable with this converter will be insufficient for our application. To achieve a higher resolution, a software and hardware interface will be created to connect the touch pad directly into the A/D hardware of the computer system being employed to develop the control system. The 12-bit A/D converters included will increase the possible resolution from the screen to 4096x4096, a 16-fold increase in resolution. This system will use MATLAB code in the Simulink model to pulse the excite pins of the touch pad, and simultaneously retrieve A/D samples from the output pin. The code will do this for each axis, back and forth, to create (X,Y) coordinate pairs for use in the control system code. We believe that using this level of integration, we can easily best the provided controller s sampling rate of samples per second. Table 3.2: Touchpad Pinout Axis Xe + Xe Y e + Y e Xs + Xs Y s + Y s X 5v GND NC READ Ref+ Ref- NC NC Y NC READ 5v GND NC NC Ref+ Ref Inclinometer The ball-on-plate system is based on the concept of balance. However, in order to be balanced, the system has to know what it means to be balanced. This means having both axes exactly parallel to ground, perpendicular to gravity. To accomplish this, inclinometers will be installed on each of the two tilt axes. This will make certain that during initial start-up and calibration, the system starts in a position that it knows to be zero. The inclinometers will be attached to the tilt axes, and their output signal interfaced directly to the A/D converters of the computer system. These signals will then be read from the MATLAB code for use in the system calibration during start-up. 12

15 Chapter 4 Verification 4.1 Testing Procedure Though little testing will be necessary for the newly machined parts, it should be noted that they must be accurately made. It is especially important that the axle be straight and the holes in the yoke be of the proper size and exact placement in the yoke so that the platform will properly spin about the tilt axis. This can be tested by simple measurement and observation. The test of the motors ability to perform their task will be quite simply whether they are able to rotate this heavy system at the speeds desired in order to control the ball. This will be testable with a Simulink/MATLAB setup. Various inputs and the resulting position graphs read from the encoder can easily be used to test the limits of the motor s ability. The optical encoder s performance also can easily be tested with MATLAB. Especially of interest will be resulting velocity graphs that will be a result of integrating the position feedback provided by the encoder. Testing of the touch-screen subsystem will be necessary to ensure accurate position information will be available for feedback in the control algorithm. In addition, the touch-screen sensitivity to the ball weight and the effectiveness of the rubber membrane covering the screen, will require testing to ensure that all components of this subsystem are effective but in no way excessive. To test touch-screen feedback, once the subsystem has been implemented the ball will have to be placed on the screen at several locations and the position read by the subsystem compared to the actual location of the ball. Precise measuring will be necessary here. It may also be desirable to check for precision of position feedback for the ball in motion, however it will be nearly impossible to measure this accurately enough for comparison in the physical world. At minimum however, a plot of the balls path could be observed. The smoother this resulting plot, the better. During the testing of the position feedback, the effect of the ball s weight on the touch-screen must also be noted. If the ball is not always successful in exciting the touch-screen, it will be necessary to increase the size and weight of the ball. However if the ball is performing perfectly, this will be an indication that a smaller ball of less weight could be used. This is desirable as there is finite amount of space on the platform and the 13

16 more space that is available, the greater the range of movement the ball will have on the plate. One less complex, but still important test of this subsystem remains. The ball must be placed on the surface when tilted at its steepest angle and observed. If the ball rolls, then the rubber membrane is providing sufficient friction. However if any slipping at all occurs, it will be necessary to upgrade to a thicker membrane. This however could also affect the necessary weight of the ball and perhaps position feedback, so this simple test of the touch-screen subsystem will be performed first. 4.2 Tolerance Analysis The physical machine parts require great accuracy. While this should not be overly difficult to implement and test, any deviations from the correct measurements could lead to unrecoverable faults in the performance of the system. Care will have to be taken in their construction and the final test of their performance will be the smoothness of rotation of the tilt axis which they implement. It also is important to the success of the system that the motors and encoders perform well. However, in the event that they are sub-par some correction other than replacement will need to be implemented if the system is still to be a success. There simply are no better motors or encoders available to us. Fortunately, they should be satisfactory As stated earlier, it is necessary for the touch-screen subsystem to be highly accurate. If the position feedback for the ball is not accurate, the overall ability to control the system will be greatly reduced. The system will be tested as described in the prior section and any possible calibration or noise cancellation will be implemented. The final test will of course be the overall ability of the system. Barring some unforeseen problem with the machined parts, motors, or encoders, it is likely that the greatest barrier for perfection in the performance of the system will be the accuracy of the touch-screen subsystem. If this subsystem does not provide an accurate error signal, an ideal control system will never be achieved. 14

17 Chapter 5 Cost and Schedule 5.1 Cost Analysis The cost for developing the system can be broken down into the cost for parts, the cost for raw materials, and the cost for labor. Table 5.1: List of parts Item Qty Cost Total Source 1 1/4 diam. 440C stainless ball 1 $9.17 $9.17 McMaster-Carr Dynapro wire resistive touch pad 1 $39 $39 Ebay Pittman motor GM9234S017 (pan) 1 $97.59 $97.59 Supplied Pittman motor GM9234S017 (tilt) 1 $97.59 $97.59 Supplied Pan gear A 1 $9.97 $9.97 Supplied Pan gear B 1 $22.02 $22.02 Supplied Tilt gear A 1 $7.95 $7.95 Supplied Tile gear B 1 $22.02 $22.02 Supplied Pan belt 1 $3.92 $3.92 Supplied Tilt belt 1 $4.00 $4.00 Supplied Total $ Table 5.2: List of raw materials Item Qty Cost Total Source 1/2 aluminum stock 5 lb $4/lb $20 RPI Machine Shop 1 1/4 diam. aluminum round stock 4 lb $4/lb $16 RPI Machine Shop 1/16 latex rubber membrane 1 $9.38 (12 x12 ) $9.38 McMaster-Carr Total $

18 Table 5.3: Labor costs Description Hours Cost Total Andrews, Greg (engineer) 300 $35/hr $10,500 Colasuonno, Chris (engineer) 300 $35/hr $10,500 Herrmann, Aaron (engineer) 300 $35/hr $10,500 Caskey, Ryan (machinist) 10 $35/hr $350 Total 910 $31, Phases The development of the ball-on-plate system can be generalized into several phases to overall project completion. Basic system completion entails the ability to balance a ball in a static position on the sensor plate. The target advanced system builds on the basic system and allows for simple as well as complex trajectory following of the ball. 1. Initial development System modeling Using physical parameters for the individual system pieces and a CAD model, the inertia and mass matrices can be generated. These can then be used to generate the coriolis/centrifugal matrices, which can be used to generate the dynamics of the system. Additional parts construction Additional parts are needed for the central plate yoke, which need to be machined in the machine shop. 2. Identification Parameter identification Using a MATLAB script, the physical system can be run through several tests to determine the parameters describing the full model, including friction terms. Validation Once these parameters are defined, the physical system response can be compared to the projected response, and the std.dev of this response can be used to further define the system parameters. 3. Controller Control design Once the system is defined, the controller can be developed. Several different designs are planned, including a PID controller, a State-feedback observer controller, and an Optimal controller. Sensors The sensor development and integration will need to be finalized by this point, including the testing of the inclinometers, touch pad, and encoders. 4. Integration Integration Move the sensors from testing into the physical system. Also, integrate the control design into the Simulink system for usage with MATLAB xpc target. Testing With the control system now operating, test to make sure the system can be calibrated, and maintains position to within a small percentage of the desired position. Also, check for response time and disturbance rejection in the joint angles. 16

19 5. Basic System Static ball balancing Move system from basic controller to balancing system. This includes feedback from the touchpad in order to monitor ball position and dynamics in an attempt to maintain static ball position. Disturbance rejection With the ball static, attempt to nudge the ball from its current position, to make certain that the control system can compensate for unknown random forces. 6. Advanced System Line trajectory tracking (slow) With static ball balancing working, work on moving the ball along a line trajectory (e.g. y = x), such that it can traverse from one corner of the work surface to another. Line trajectory tracking (fast) Increase the speed of the traverse until the system can move the ball rapidly, but under control. Complex trajectory tracking Now that a line path can be rapidly tracked, attempt to make figureeight, circular or more complex paths for the ball to follow. MATLAB GUI interface to tracking (optional) Develop a MATLAB gui to allow for simplified control of different tracking examples. This system could possibly include a grid on which a user could pick points, and have the ball trace out a simple path. 5.3 Schedule A proposed overall development schedule is shown in Table 5.4. While preliminary, the schedule is realistic and aims for advanced system completion before the final demonstration day. The schedule also includes information on task breakdown between members; however, the foreseen complexity of the project and of each task suggests that each task might likely be completed by the group at large, with the designated team member merely acting as lead. 17

20 Table 5.4: Schedule Week Task Member Week 4 Model development Greg Research sensing hardware Aaron Find machinist to make metal parts Chris Week 5 Model development Greg Test sensing hardware Aaron Work on machining parts Chris Work on project proposal Team Week 6 Model development Greg Research sensing interface options Aaron Friction ID script Chris Work on project proposal Team Week 7 Friction ID Team Week 8 Model validation Chris Develop sensor interface Aaron Preliminary control design Greg Week 9 Control design Greg, Chris Finish sensor interface Aaron Week 10 Integration of sensors Aaron Control system testing Greg Sensor testing Chris Week 11 Static ball balancing Team Week 12 Complex path following Team Week 13 Work on final report Team Final demonstration Team Week 14 Work in final report Team Final presentation Team Week 15 Final report Team 18

21 Bibliography [1] 3M Touch Systems. SC4 Touch Screen Controller: User s Guide, 2nd edition, [2] Dr. Murat Arcak. Discrete time systems - lecture notes [3] S. Awtar, C. Bernard, N. Boklund, A. Master, D. Ueda, and K. Craig. Mechatronic design of a ball-onplate balancing system. Technical report, Rensselaer Polytechnic Institute, [4] Graham Goodwin, Stefan Graebe, and Mario Salgado. Control system design - ball-on-plate tutorial. Available WWW: sim.html, [5] Eric W. Weisstein. Moment of inertia - sphere. Available WWW: physics/momentofinertiasphere.html. [6] Dr. John Wen. Control system design - lecture notes

22 Chapter 6 Statement of Contribution For the project proposal document: Greg completed the following sections: Model development Controller design and tuning Simulation CAD model Chris completed the following sections: Performance specs vs. available components Parameter identification Testing procedures Tolerance analysis Aaron completed the following sections: Abstract Introduction Objectives Design alternatives Subsystem development Cost analysis Phases Schedule 20

23 Greg Andrews Chris Colasuonno Aaron Herrmann 21

24 Appendix A Touch pad data sheet 22

25 23

26 Appendix B Coordinate System - Body A 24

27 Appendix C Coordinate System - Body B 25

28 Appendix D CAD Model 26

MAZE TAVERSING SYSTEM Proposal for ECSE-4962 Control System Design

MAZE TAVERSING SYSTEM Proposal for ECSE-4962 Control System Design MAZE TAVERSING SYSTEM Proposal for ECSE-4962 Control System Design Rich Pingelski Tushar Shah Mark Stenpeck Ian Trettel February 22, 2006 Rensselaer Polytechnic Institute Abstract The goal of this project

More information

Self-Correcting Projectile Launcher. Josh Schuster Yena Park Diana Mirabello Ryan Kindle

Self-Correcting Projectile Launcher. Josh Schuster Yena Park Diana Mirabello Ryan Kindle Self-Correcting Projectile Launcher Josh Schuster Yena Park Diana Mirabello Ryan Kindle Motivation & Applications Successfully reject disturbances without use of complex sensors Demonstrate viability of

More information

Rensselaer Polytechnic Institute

Rensselaer Polytechnic Institute Rensselaer Polytechnic Institute To: Professor John T Wen. From: Team 2: Adjima Mareira, Teresa Bernardi, Brian Lewis, Matthew Rosmarin Subject: Control System Design Conceptual Design Date: 1/31/2006

More information

Automatic Pouring Robot. Akilah Harris-Williams Adam Olmstead Philip Pratt-Szeliga Will Roantree

Automatic Pouring Robot. Akilah Harris-Williams Adam Olmstead Philip Pratt-Szeliga Will Roantree Automatic Pouring Robot Akilah Harris-Williams Adam Olmstead Philip Pratt-Szeliga Will Roantree Overview Objective and Motivation Mechanical System Modeling, Simulation and Verification Tilt Pan Pouring

More information

Polar and Polygon Path Traversal of a Ball and Plate System

Polar and Polygon Path Traversal of a Ball and Plate System Polar and Polygon Path Traversal of a Ball and Plate System Aneeq Zia Electrical Engineering Department, LUMS School of Science and Engineering D.H.A, Lahore Cantt, 54792, Pakistan aneeq91@hotmail.com

More information

IMPLEMENTATION OF BALL-AND-BEAM CONTROL SYSTEM AS AN INSTANCE OF SIMULINK TO 32-BIT MICROCONTROLLER INTERFACE

IMPLEMENTATION OF BALL-AND-BEAM CONTROL SYSTEM AS AN INSTANCE OF SIMULINK TO 32-BIT MICROCONTROLLER INTERFACE POZNAN UNIVE RSITY OF TE CHNOLOGY ACADE MIC JOURNALS No 76 Electrical Engineering 2013 Krzysztof NOWOPOLSKI* IMPLEMENTATION OF BALL-AND-BEAM CONTROL SYSTEM AS AN INSTANCE OF SIMULINK TO 32-BIT MICROCONTROLLER

More information

TESTSAT STRUCTURE AND INTERFACE DESIGN & FABRICATION. Jonathan R. Chinen College of Engineering University of Hawai i at Mānoa Honolulu, HI 96822

TESTSAT STRUCTURE AND INTERFACE DESIGN & FABRICATION. Jonathan R. Chinen College of Engineering University of Hawai i at Mānoa Honolulu, HI 96822 TESTSAT STRUCTURE AND INTERFACE DESIGN & FABRICATION Jonathan R. Chinen College of Engineering University of Hawai i at Mānoa Honolulu, HI 96822 ABSTRACT Under the Hawai i Space Flight Laboratory (HSFL),

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

Design and Development of Unmanned Tilt T-Tri Rotor Aerial Vehicle

Design and Development of Unmanned Tilt T-Tri Rotor Aerial Vehicle Design and Development of Unmanned Tilt T-Tri Rotor Aerial Vehicle K. Senthil Kumar, Mohammad Rasheed, and T.Anand Abstract Helicopter offers the capability of hover, slow forward movement, vertical take-off

More information

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

Simulink Based Robot Arm Control Workstation. Figure 1-1 High Level Block Diagram

Simulink Based Robot Arm Control Workstation. Figure 1-1 High Level Block Diagram Introduction: This project consists of designing a software-based control workstation in the Simulink environment using the SimMechanics Toolbox. The Quanser robot arm system will be modeled using 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

Introduction to Control Systems Design

Introduction to Control Systems Design Experiment One Introduction to Control Systems Design Control Systems Laboratory Dr. Zaer Abo Hammour Dr. Zaer Abo Hammour Control Systems Laboratory 1.1 Control System Design The design of control systems

More information

DOUBLE ARM JUGGLING SYSTEM Progress Report for ECSE-4962 Control Systems Design

DOUBLE ARM JUGGLING SYSTEM Progress Report for ECSE-4962 Control Systems Design DOUBLE ARM JUGGLING SYSTEM Progress Report for ECSE-4962 Control Systems Design Team Trinell Ball John Kua Linda Rivera March 29, 26 Rensselaer Polytechnic Institute Executive Summary Our goal for this

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

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

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

Kinematics And Dynamics Lab Manual EXPERIMENT NO:01 STATIC & DYNAMIC BALANCE EXPERIMENT

Kinematics And Dynamics Lab Manual EXPERIMENT NO:01 STATIC & DYNAMIC BALANCE EXPERIMENT EXPERIMENT NO:01 STATIC & DYNAMIC BALANCE EXPERIMENT Aim To balance the given masses statically by drawing force polygon and couple polygon and dynamically by trial and error method on a shaft. Theory

More information

Pick and Place Robot Simulation

Pick and Place Robot Simulation Pick and Place Robot Simulation James Beukers Jordan Jacobson ECE 63 Fall 4 December 6, 4 Contents Introduction System Overview 3 3 State Space Model 3 4 Controller Design 6 5 Simulation and Results 7

More information

A NOUVELLE MOTION STATE-FEEDBACK CONTROL SCHEME FOR RIGID ROBOTIC MANIPULATORS

A NOUVELLE MOTION STATE-FEEDBACK CONTROL SCHEME FOR RIGID ROBOTIC MANIPULATORS A NOUVELLE MOTION STATE-FEEDBACK CONTROL SCHEME FOR RIGID ROBOTIC MANIPULATORS Ahmad Manasra, 135037@ppu.edu.ps Department of Mechanical Engineering, Palestine Polytechnic University, Hebron, Palestine

More information

SAMCEF for ROTORS. Chapter 3.2: Rotor modeling. This document is the property of SAMTECH S.A. MEF A, Page 1

SAMCEF for ROTORS. Chapter 3.2: Rotor modeling. This document is the property of SAMTECH S.A. MEF A, Page 1 SAMCEF for ROTORS Chapter 3.2: Rotor modeling This document is the property of SAMTECH S.A. MEF 101-03-2-A, Page 1 Table of contents Introduction Introduction 1D Model 2D Model 3D Model 1D Models: Beam-Spring-

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

Self-Correcting Projectile Launcher: Proposal for ECSE-4460 Control Systems Design

Self-Correcting Projectile Launcher: Proposal for ECSE-4460 Control Systems Design Self-Correcting Projectile Launcher: Proposal for ECSE-4460 Control Systems Design Josh Schuster Yena Park Diana Mirabello Ryan Kindle March 1, 2005 Rensselaer Polytechnic Institute ABSTRACT The design

More information

AC : DEVELOPMENT AND INITIAL ANALYSIS OF A MINI CNC RAPID DEVELOPMENT SYSTEM

AC : DEVELOPMENT AND INITIAL ANALYSIS OF A MINI CNC RAPID DEVELOPMENT SYSTEM AC 21-1427: DEVELOPMENT AND INITIAL ANALYSIS OF A MINI CNC RAPID DEVELOPMENT SYSTEM Lie Tang, Missouri University of Science and Technology Robert Landers, Missouri University of Science and Technology

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

Piezo LEGS. Rotary 30mNm. Direct drive backlash free Integrated Absolute Encoder Microradian resolution No power draw in hold position Quick response

Piezo LEGS. Rotary 30mNm. Direct drive backlash free Integrated Absolute Encoder Microradian resolution No power draw in hold position Quick response Rotary 30mNm Direct drive backlash free Integrated Absolute Encoder Microradian resolution No power draw in hold position Quick response The LR7 is a high precision motor in the second generation of Piezo

More information

ON THE VELOCITY OF A WEIGHTED CYLINDER DOWN AN INCLINED PLANE

ON THE VELOCITY OF A WEIGHTED CYLINDER DOWN AN INCLINED PLANE ON THE VELOCITY OF A WEIGHTED CYLINDER DOWN AN INCLINED PLANE Raghav Grover and Aneesh Agarwal RG (Grade 12 High School), AA (Grade 11 High School) Department of Physics, The Doon School, Dehradun. raghav.503.2019@doonschool.com,

More information

MultiCam 1000 Series CNC Router Feature and Specification Guide. Maximum Flexibility Made Affordable! MultiCam. Ideal for Cutting: Wood

MultiCam 1000 Series CNC Router Feature and Specification Guide. Maximum Flexibility Made Affordable! MultiCam. Ideal for Cutting: Wood MultiCam 1000 Series CNC Router Feature and Specification Guide Maximum Flexibility Made Affordable! MultiCam accepted the industry challenge to build a rigid, reliable CNC machine platform with excellent

More information

AVT Model Tripod.

AVT Model Tripod. AVT Model Tripod www.ravelliphoto.com Product Overview: The Ravelli AVT professional tripod is a high performance, fluid drag tripod that provides smooth continuous drag control and operates on both pan

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

XSLIDE. XSlide Positioning System. Manual and Motorized. Compact Positioning Stage. Long life, precise movement, greater value

XSLIDE. XSlide Positioning System. Manual and Motorized. Compact Positioning Stage. Long life, precise movement, greater value XSlide Positioning System Long life, precise movement, greater value Manual and Motorized Compact Positioning Stage XSLIDE Ideal for limited space applications Velmex Versatility Velmex positioning products

More information

QUANSER Flight Control Systems Design. 2DOF Helicopter 3DOF Helicopter 3DOF Hover 3DOF Gyroscope. Quanser Education Solutions Powered by

QUANSER Flight Control Systems Design. 2DOF Helicopter 3DOF Helicopter 3DOF Hover 3DOF Gyroscope. Quanser Education Solutions Powered by QUANSER Flight Control Systems Design 2DOF Helicopter 3DOF Helicopter 3DOF Hover 3DOF Gyroscope Quanser Education Solutions Powered by 2 DOF Helicopter What does it represent? Classic helicopter with main

More information

HB5M. Hollow Bore Optical Encoder Page 1 of 6. Description. Related Products & Accessories. Features

HB5M. Hollow Bore Optical Encoder Page 1 of 6. Description. Related Products & Accessories. Features Description HB5M Page 1 of 6 The HB5M is a hollow bore (hollow shaft / thru-bore) optical encoder with a machined aluminum enclosure and a clear anodized protective finish. The HB5M optical incremental

More information

Research on time optimal trajectory planning of 7-DOF manipulator based on genetic algorithm

Research on time optimal trajectory planning of 7-DOF manipulator based on genetic algorithm Acta Technica 61, No. 4A/2016, 189 200 c 2017 Institute of Thermomechanics CAS, v.v.i. Research on time optimal trajectory planning of 7-DOF manipulator based on genetic algorithm Jianrong Bu 1, Junyan

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

RMCWin. WalkThrough. This document is intended for walking through RMCWin with customers over the telephone/internet.

RMCWin. WalkThrough. This document is intended for walking through RMCWin with customers over the telephone/internet. RMCWin WalkThrough This document is intended for walking through RMCWin with customers over the telephone/internet. Figure 1. Typical RMC100 and RMCWin installation. PC running RMCWin Setup and Diagnostics

More information

Simulation. x i. x i+1. degrees of freedom equations of motion. Newtonian laws gravity. ground contact forces

Simulation. x i. x i+1. degrees of freedom equations of motion. Newtonian laws gravity. ground contact forces Dynamic Controllers Simulation x i Newtonian laws gravity ground contact forces x i+1. x degrees of freedom equations of motion Simulation + Control x i Newtonian laws gravity ground contact forces internal

More information

MDrive Linear Actuator

MDrive Linear Actuator MDrive Linear Actuator Compact, integrated all-in-one linear motion systems MDrive 23 Plus Linear Actuator, Description MDrive Plus Linear Actuator Presentation The MDrive Plus Linear Actuator is an integrated

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

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

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

2-Axis Brushless Gimbal User Manual

2-Axis Brushless Gimbal User Manual 2-Axis Brushless Gimbal User Manual I Introduction AGM 2-axis brushless gimbal is designed to accommodate the GoPro Hero3 camera, enhancing such various aspects of aerial videography as entertainment,

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

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

Design of a Precision Robot Wrist Interface. Patrick Willoughby Advisor: Alexander Slocum MIT Precision Engineering Research Group

Design of a Precision Robot Wrist Interface. Patrick Willoughby Advisor: Alexander Slocum MIT Precision Engineering Research Group Design of a Precision Robot Wrist Interface Patrick Willoughby Advisor: Alexander Slocum MIT Precision Engineering Research Group Project Summary Problem: Current bolted robot wrist replacements are inaccurate,

More information

Datasheet 2102 SERIES TWO-AXIS POSITIONING AND RATE TABLE SYSTEM

Datasheet 2102 SERIES TWO-AXIS POSITIONING AND RATE TABLE SYSTEM Datasheet 2102 SERIES TWO-AXIS POSITIONING AND RATE TABLE SYSTEM FEATURES Position Accuracy: ± 30 arc seconds (both axes) Rate Accuracy: ± 0.01% Max Rate (varies depending on axis configuration): Inner

More information

COMPARISON OF TWO INSTRUMENT DESIGNS FOR NON-CONTACT MEASUREMENT OF GOSSAMER MIRRORS

COMPARISON OF TWO INSTRUMENT DESIGNS FOR NON-CONTACT MEASUREMENT OF GOSSAMER MIRRORS COMPARISON OF TWO INSTRUMENT DESIGNS FOR NON-CONTACT MEASUREMENT OF GOSSAMER MIRRORS Phil Smith and R. Ryan Vallance Precision Systems Laboratory, University of Kentucky * Abstract Lightweight, large format

More information

Applications: Industrial Automation, Cranes, Hoists, Utility Vehicles, Off-highway, Ag, and Forestry Equipment

Applications: Industrial Automation, Cranes, Hoists, Utility Vehicles, Off-highway, Ag, and Forestry Equipment TECHNICAL DATASHEET #TDA06020 CAN (SAE J1939) or (CANopen ) with Electronic Assistant P/N: A06020 Features: 1 or 2 axis inclination or slope sensors 2 axis (-80º 80º), functional up to +90 º 1 axis, vertically

More information

VISION-TRACKING TURRET SYSTEM. by Jason Lam John Lee Jonathan Rothberg. ECSE-4962 Control Systems Design. May 4, 2005

VISION-TRACKING TURRET SYSTEM. by Jason Lam John Lee Jonathan Rothberg. ECSE-4962 Control Systems Design. May 4, 2005 VISION-TRACKING TURRET SYSTEM by Jason Lam John Lee Jonathan Rothberg ECSE-4962 Control Systems Design May 4, 2005 Rensselaer Polytechnic Institute ABSTRACT The goal of this project is to successfully

More information

Physics 101, Lab 1: LINEAR KINEMATICS PREDICTION SHEET

Physics 101, Lab 1: LINEAR KINEMATICS PREDICTION SHEET Physics 101, Lab 1: LINEAR KINEMATICS PREDICTION SHEET After reading through the Introduction, Purpose and Principles sections of the lab manual (and skimming through the procedures), answer the following

More information

Ch 22 Inspection Technologies

Ch 22 Inspection Technologies Ch 22 Inspection Technologies Sections: 1. Inspection Metrology 2. Contact vs. Noncontact Inspection Techniques 3. Conventional Measuring and Gaging Techniques 4. Coordinate Measuring Machines 5. Surface

More information

Torque-Position Transformer for Task Control of Position Controlled Robots

Torque-Position Transformer for Task Control of Position Controlled Robots 28 IEEE International Conference on Robotics and Automation Pasadena, CA, USA, May 19-23, 28 Torque-Position Transformer for Task Control of Position Controlled Robots Oussama Khatib, 1 Peter Thaulad,

More information

ROSE-HULMAN INSTITUTE OF TECHNOLOGY

ROSE-HULMAN INSTITUTE OF TECHNOLOGY More Working Model Today we are going to look at even more features of Working Model. Specifically, we are going to 1) Learn how to add ropes and rods. 2) Learn how to connect object using joints and slots.

More information

Home All Products Support Special Offers Contact Us. Home. Application Note for Draw Wire Transducer Accuracy

Home All Products Support Special Offers Contact Us. Home. Application Note for Draw Wire Transducer Accuracy Providing the Ultimate Solutions in Precision Displacement Sensors Order Site Map Follow 29 Home All Products Support Special Offers Contact Us Search Home Application Note for Draw Wire Transducer Accuracy

More information

EXPLORER CLASSIC BRIDGE COORDINATE MEASURING MACHINE PRODUCT BROCHURE

EXPLORER CLASSIC BRIDGE COORDINATE MEASURING MACHINE PRODUCT BROCHURE EXPLORER CLASSIC BRIDGE COORDINATE MEASURING MACHINE PRODUCT BROCHURE EXPLORER CLASSIC UNSURPASSED MEASURING RANGE Available in sizes to suit every kind of business, Explorer Classic machines combine innovative

More information

CONTROLO th Portuguese Conference on Automatic Control

CONTROLO th Portuguese Conference on Automatic Control CONTROLO 2008 8 th Portuguese Conference on Automatic Control University of Trás-os-Montes and Alto Douro, Vila Real, Portugal July 21-23, 2008 414 BALL AND BEAM VIRTUAL LABORATORY: A TEACHING AID IN AUTOMATIC

More information

MDrive Linear Actuator

MDrive Linear Actuator MDrive Linear Actuator Compact, integrated all-in-one linear motion systems MDrive 14 Plus Linear Actuator, Description MDrive Plus Linear Actuator Presentation The MDrive Plus Linear Actuator is an integrated

More information

Closed Loop Step Response

Closed Loop Step Response TAKE HOME LABS OKLAHOMA STATE UNIVERSITY Closed Loop Step Response by Sean Hendrix revised by Trevor Eckert 1 OBJECTIVE This experiment adds feedback to the Open Loop Step Response experiment. The objective

More information

1 in = 25.4 mm 1 m = ft g = 9.81 m/s 2

1 in = 25.4 mm 1 m = ft g = 9.81 m/s 2 ENGR 122 Section Instructor: Name: Form#: 52 Allowed materials include calculator (without wireless capability), pencil or pen. Honor Statement: On my honor, I promise that I have not received any outside

More information

Enhanced Performance of a Slider Mechanism Through Improved Design Using ADAMS

Enhanced Performance of a Slider Mechanism Through Improved Design Using ADAMS Enhanced Performance of a Slider Mechanism Through Improved Design Using ADAMS (Nazeer Shareef, Sr. R&D Engr., BAYER CORP., Elkhart, IN) Introduction Understanding of the influence of critical parameters

More information

AMG Series. Motorized Position and Rate Gimbals. Continuous 360 rotation of azimuth and elevation including built-in slip ring

AMG Series. Motorized Position and Rate Gimbals. Continuous 360 rotation of azimuth and elevation including built-in slip ring AMG Series Optical Mounts AMG Series Motorized Position and Rate Gimbals Continuous rotation of azimuth and elevation including built-in slip ring High accuracy angular position and rate capability Direct-drive

More information

Handout. and. brief description. Marine Gravity Meter KSS 32- M

Handout. and. brief description. Marine Gravity Meter KSS 32- M and brief description of Marine Gravity Meter KSS 32- M Copyright 1999-2010 Bodensee Gravitymeter Geosystem GmbH All rights reserved 1 KSS32-M Marine Gravity Meter Cover removed Copyright 1999-2010 Bodensee

More information

STEP 1: MODULE MOUNTING / WIRING:

STEP 1: MODULE MOUNTING / WIRING: VER1.0 PINOUT DIAGRAM: PORT 1 - INPUT 1 (S.BUS, PWM, PPM INPUT) PORT 2 - INPUT 2 (PWM MODE INPUT OR AUX OUTPUT DEFINED IN SOFTWARE) PORT 3 - OUTPUT 1 (S.BUS OUTPUT) PORT 4 - OUTPUT 2 (SERVO OUTPUT) PORT

More information

[ Ω 1 ] Diagonal matrix of system 2 (updated) eigenvalues [ Φ 1 ] System 1 modal matrix [ Φ 2 ] System 2 (updated) modal matrix Φ fb

[ Ω 1 ] Diagonal matrix of system 2 (updated) eigenvalues [ Φ 1 ] System 1 modal matrix [ Φ 2 ] System 2 (updated) modal matrix Φ fb Proceedings of the IMAC-XXVIII February 1 4, 2010, Jacksonville, Florida USA 2010 Society for Experimental Mechanics Inc. Modal Test Data Adjustment For Interface Compliance Ryan E. Tuttle, Member of the

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

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

Kinematics of Machines Prof. A. K. Mallik Department of Mechanical Engineering Indian Institute of Technology, Kanpur. Module 10 Lecture 1

Kinematics of Machines Prof. A. K. Mallik Department of Mechanical Engineering Indian Institute of Technology, Kanpur. Module 10 Lecture 1 Kinematics of Machines Prof. A. K. Mallik Department of Mechanical Engineering Indian Institute of Technology, Kanpur Module 10 Lecture 1 So far, in this course we have discussed planar linkages, which

More information

Implementation of an Automated Sorting System with a 2-Link Robotic Arm

Implementation of an Automated Sorting System with a 2-Link Robotic Arm Implementation of an Automated Sorting System with a 2-Link Robotic Arm Thomas Carlone, Frederik Clinckemaille, Raymond Short Worcester Polytechnic Institute, Worcester, MA, USA E-mail: tomcarlone@wpi.edu,

More information

Attitude Control for Small Satellites using Control Moment Gyros

Attitude Control for Small Satellites using Control Moment Gyros Attitude Control for Small Satellites using Control Moment Gyros V Lappas a, Dr WH Steyn b, Dr CI Underwood c a Graduate Student, University of Surrey, Guildford, Surrey GU 5XH, UK b Professor, University

More information

ME350 WN17 Semester FINAL REPORT

ME350 WN17 Semester FINAL REPORT ME350 WN17 Semester FINAL REPORT Team 52 Austin Broda Marcos Cavallin Nikko Van Crey David Van Dyke Mitchell Williams GSI: Kyle Kenkel We have fully abided by the University of Michigan College of Engineering

More information

Piezo LEGS. Linear 6N

Piezo LEGS. Linear 6N Linear 6N Direct drive backlash free Nanometer resolution Simple drive electronics No power draw in hold position Quick response and high speed dynamics The LL10 linear motor is intended for a large range

More information

AC : ADAPTIVE ROBOT MANIPULATORS IN GLOBAL TECHNOLOGY

AC : ADAPTIVE ROBOT MANIPULATORS IN GLOBAL TECHNOLOGY AC 2009-130: ADAPTIVE ROBOT MANIPULATORS IN GLOBAL TECHNOLOGY Alireza Rahrooh, University of Central Florida Alireza Rahrooh is aprofessor of Electrical Engineering Technology at the University of Central

More information

(Refer Slide Time: 00:01:27 min)

(Refer Slide Time: 00:01:27 min) Computer Aided Design Prof. Dr. Anoop Chawla Department of Mechanical engineering Indian Institute of Technology, Delhi Lecture No. # 01 An Introduction to CAD Today we are basically going to introduce

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

Data Association for SLAM

Data Association for SLAM CALIFORNIA INSTITUTE OF TECHNOLOGY ME/CS 132a, Winter 2011 Lab #2 Due: Mar 10th, 2011 Part I Data Association for SLAM 1 Introduction For this part, you will experiment with a simulation of an EKF SLAM

More information

A Six Degree of Freedom, Piezoelectrically Actuated Translation Stage

A Six Degree of Freedom, Piezoelectrically Actuated Translation Stage A Six Degree of Freedom, Piezoelectrically Actuated Translation Stage Richard M. Seugling, Roy H.R. Jacobs, Stuart T. Smith, Lowell P. Howard, Thomas LeBrun Center for Precision Metrology, UNC Charlotte,

More information

Appendix A Physiological Model of the Elbow in MATLAB/Simulink

Appendix A Physiological Model of the Elbow in MATLAB/Simulink 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.

More information

Driven Cavity Example

Driven Cavity Example BMAppendixI.qxd 11/14/12 6:55 PM Page I-1 I CFD Driven Cavity Example I.1 Problem One of the classic benchmarks in CFD is the driven cavity problem. Consider steady, incompressible, viscous flow in a square

More information

Practical Training with the maxon Selection Program (MSP)

Practical Training with the maxon Selection Program (MSP) Practical Training with the maxon Selection Program (MSP) Purposes and Goals The participants - learn how to use the main parts of the maxon selection program. - make a motor-gearhead selection for continuous

More information

Project 1 : Dead Reckoning and Tracking

Project 1 : Dead Reckoning and Tracking CS3630 Spring 2012 Project 1 : Dead Reckoning and Tracking Group : Wayward Sons Sameer Ansari, David Bernal, Tommy Kazenstein 2/8/2012 Wayward Sons CS3630 Spring 12 Project 1 Page 2 of 12 CS 3630 (Spring

More information

DELTA TAU Data Systems, Inc.

DELTA TAU Data Systems, Inc. DELTA TAU Data Systems, Inc. Last revision: 12/5/01 Why PMAC Controllers Are Easy To Use Delta Tau s PMAC and Turbo PMAC families of controllers justly have the reputation as being the most powerful and

More information

Cam makes a higher kinematic pair with follower. Cam mechanisms are widely used because with them, different types of motion can be possible.

Cam makes a higher kinematic pair with follower. Cam mechanisms are widely used because with them, different types of motion can be possible. CAM MECHANISMS Cam makes a higher kinematic pair with follower. Cam mechanisms are widely used because with them, different types of motion can be possible. Cams can provide unusual and irregular motions

More information

MINISCALE PLUS Product Overview

MINISCALE PLUS Product Overview 10 MINISCALE PLUS Product Overview This extraordinary innovation combines «movement» with «measuring» in a highly integrated design. MINISCALE PLUS makes the most compact applications possible and simplifies

More information

VIBRATION-ISOLATION SYSTEM WITH GYROSCOPIC STABILIZER

VIBRATION-ISOLATION SYSTEM WITH GYROSCOPIC STABILIZER 11 th International Conference on Vibration Problems Z. Dimitrovová et al. (eds.) Lisbon, Portugal, 9-12 September 2013 VIBRATION-ISOLATION SYSTEM WITH GYROSCOPIC STABILIZER Jan Škoda* 1, Jan Šklíba 2

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

Motion Control Primer. Direct load position sensing with secondary feedback encoders. White Paper

Motion Control Primer. Direct load position sensing with secondary feedback encoders. White Paper Motion Control Primer Direct load position sensing with secondary feedback encoders White Paper White Paper Position sensing primer Direct load position sensing with secondary feedback encoders In closed-loop

More information

KGCOE MSD Technical Review Agenda P11213: Land Vehicle for Education: Modular Student Attachment

KGCOE MSD Technical Review Agenda P11213: Land Vehicle for Education: Modular Student Attachment KGCOE MSD Technical Review Agenda P11213: Land Vehicle for Education: Modular Student Attachment Meeting Purpose: 1. Introduction and review of the project 2. Design project recap 3. Mechanical design

More information

D115 The Fast Optimal Servo Amplifier For Brush, Brushless, Voice Coil Servo Motors

D115 The Fast Optimal Servo Amplifier For Brush, Brushless, Voice Coil Servo Motors D115 The Fast Optimal Servo Amplifier For Brush, Brushless, Voice Coil Servo Motors Ron Boe 5/15/2014 This user guide details the servo drives capabilities and physical interfaces. Users will be able to

More information

INSTITUTE OF AERONAUTICAL ENGINEERING

INSTITUTE OF AERONAUTICAL ENGINEERING Name Code Class Branch Page 1 INSTITUTE OF AERONAUTICAL ENGINEERING : ROBOTICS (Autonomous) Dundigal, Hyderabad - 500 0 MECHANICAL ENGINEERING TUTORIAL QUESTION BANK : A7055 : IV B. Tech I Semester : MECHANICAL

More information

ALAR Series. Direct Drive, Large-Aperture, Rotary Stage. 5 different aperture sizes: 100 mm, 150 mm, 200 mm, 250 mm, 325 mm

ALAR Series. Direct Drive, Large-Aperture, Rotary Stage. 5 different aperture sizes: 100 mm, 150 mm, 200 mm, 250 mm, 325 mm LR Series Rotary Stages LR Series Direct Drive, Large-perture, Rotary Stage 5 different aperture sizes: 100 mm, 150 mm, 200 mm, 250 mm, 325 mm Continuous or limited travel High axial load capacity of 300-1000

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

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

Chapter 1 Introduction to Numerically Controlled Machines

Chapter 1 Introduction to Numerically Controlled Machines Chapter 1 Introduction to Numerically Controlled Machines The primary building blocks of flexible manufacturing and computer integrated manufacturing systems are numerically controlled (CNC) machine tools.

More information

TEAM 12: TERMANATOR PROJECT PROPOSAL. TEAM MEMBERS: Donald Eng Rodrigo Ipince Kevin Luu

TEAM 12: TERMANATOR PROJECT PROPOSAL. TEAM MEMBERS: Donald Eng Rodrigo Ipince Kevin Luu TEAM 12: TERMANATOR PROJECT PROPOSAL TEAM MEMBERS: Donald Eng Rodrigo Ipince Kevin Luu 1. INTRODUCTION: This project involves the design and implementation of a unique, first-person shooting game. The

More information

Product Overview. Features

Product Overview. Features APCF1 Model Tripod Product Overview The Ravelli APCF1 is a Professional Quality Carbon Fiber Tripod providing a solid base for high-end photographic equipment. This model is a mix of carbon fiber and magnesium

More information

Mirror positioning on your fingertip. Embedded controller means tiny size plus fast, easy integration. Low power for hand-held systems

Mirror positioning on your fingertip. Embedded controller means tiny size plus fast, easy integration. Low power for hand-held systems SMALL, PRECISE, SMART IN MOTION DK-M3-RS-U-1M-20 Developer s Kit Single-Axis Mirror Positioning System Miniature piezo smart stage with built-in controller for simple, precise point-to-point positioning

More information

Abstract. Introduction:

Abstract. Introduction: Abstract This project analyzed a lifecycle test fixture for stress under generic test loading. The maximum stress is expected to occur near the shrink fit pin on the lever arm. The model was constructed

More information

CAMERA GIMBAL PERFORMANCE IMPROVEMENT WITH SPINNING-MASS MECHANICAL GYROSCOPES

CAMERA GIMBAL PERFORMANCE IMPROVEMENT WITH SPINNING-MASS MECHANICAL GYROSCOPES 8th International DAAAM Baltic Conference "INDUSTRIAL ENGINEERING 19-21 April 2012, Tallinn, Estonia CAMERA GIMBAL PERFORMANCE IMPROVEMENT WITH SPINNING-MASS MECHANICAL GYROSCOPES Tiimus, K. & Tamre, M.

More information

PrismMaster. Ultra Accurate and Fully Automated Prisms and Polygons Measurement

PrismMaster. Ultra Accurate and Fully Automated Prisms and Polygons Measurement PrismMaster Ultra Accurate and Fully Automated Prisms and Polygons Measurement PRECISION GONIOMETER PrismMaster Precision Goniometer for Angular Measurements of Optical Prisms and Polygons For years, the

More information

ALAR Series. Direct Drive, Large-Aperture, Rotary Stage. 5 different aperture sizes: 100 mm, 150 mm, 200 mm, 250 mm, 325 mm

ALAR Series. Direct Drive, Large-Aperture, Rotary Stage. 5 different aperture sizes: 100 mm, 150 mm, 200 mm, 250 mm, 325 mm LR Series Rotary Stages LR Series Direct Drive, Large-perture, Rotary Stage 5 different aperture sizes: mm, 150 mm, 00 mm, 50 mm, 35 mm Continuous or limited travel High axial load capacity of 300-0 lb

More information