SlideShare a Scribd company logo
1 of 36
Design, Analysis and Control
of an Offshore Load Transfer System

MAS501 Control Theory2- Autumn 2013
University of Agder
Grimstad Norway

Oreste Niyonsaba
Haocheng Su
Dimuthu Dharshana Arachchige
Bernard Sisara Gunawardana
Subodha Tharangi Ireshika
Jagath Sri Lal Senanayaka
Presentation Outline
 Introduction and methodology

 Crane kinematics
 Control architecture in Labview

 HIL Setup
 Control architecture in Step 7
 Results
 Discussion and Conclusion
Introduction and methodology
 Cranes are used in different Engineering activities
including offshore operations for transportation of loads
and personnel.
 Control design needs improvement to meet some of the
main criteria such as automatic tool tip tracking among
others
 Control system is aimed at maintaining the position of the
tool tip within one meter by one meter square relative to
an inertial frame of measurement is developed
 Firstly, the desired tool path is achieved in Labview, then
the control architecture is programmed in Siemens Step7
TIA environment integrated with Siemens ET200 PLC.
Introduction and methodology
 Control Architecture is plugged with crane boom to
achieve the desired movement
 A DLL file is created by modeling HMF crane in
SimulationX in order to use it in Labview software as
shown if the figure below
Introduction and methodology
 The desire is to implement the control architecture with
two P and PI controllers for controlling the tool tip
position
Crane kinematics from matlab
 Kinematics plays a significient role to establish
the traslational relastionships between global
coordinate system and the coordinate system of
crane components.

 Devided in to Forward kinematics, Inverse
kinematics, Forward Jacobian, Inverse Jacobian
and Actuator kinematics
Forward Kinematics
 Utilized to find the change of
tool tip position when the
angular positions are given
 Necessary to develop DH
(Denavit-Hartenberg) table
Inverse Kinematics
 Utilized to sketch the angular
position(q2,q3) when the tool
tip position (x,z)is known.
Forward Jacobian
 Utilized to skecth the
velocities of the actucators
when the angular velocities
are known.
 Maple was used to find the
parameters in the jacobian
matrix.
Inverse Jacobian
 Angular velociteis when the toll tip
velocities are known.
 It is obtained by differentiating the
inverse kinematics.
 This part is also implemented in
both matlab and labview.
 Inverse kinematics and inverse
Jacobian are crucial to convert the
reference positions and velocities of
the desired tool path into reference
angular positions and angular
velocities of two actuator joints.
Actuator kinematics
Used to derive relationships between angular movement of
the actuators and linear movements of the cylinders.
Actuator
Kinematics 2

Actuator
Kinematics 1

L3
L2

Law of Cosine
Analytical procedures are difficult
Polynomail Curve Fitting: ‘Polyfit’
Returns coefficients of the polynomial in descending powers.
L2 and Q2 Relation

L3 and Q3 Relation

140

40

120

20

100

0

80

-20

60

-40

40

-60

20

-80

0

-100

-20

-120

-40

-140

-60

1

1.1

1.2

1.3

1.4

1.5

1.6

1.7

1.8

1.9

2

-160
1.1

Root mean square error
Third order polynomial
Fifth order polynomial

1.2

1.3

1.4

1.5

1.6

0.0067
0.0037

1.7

1.8

1.9

2

2.1
Tool path in Labview
Operated in two segments

The path length (L) between the two locations and
angular position of the velocity vector are
geometrically found in order to guide the tool tip
along the shortest possible path

1. Initial position and target point
2. Reference square path
Tool point along the reference square path
Total Length of path s=3.914 m
s<L1

% First stretch

xDot=v;
zDot=0;
s<L1+L2
% First corner
x=R+L1+R*cos(q-pi/2);
z=R+R*sin(q-pi/2);
xDot=v*cos(q);
zDot=v*sin(q);
s<2*L1+L2)
% Second stretch
s<2*L1+2*L2)
% Second corner
s<3*L1+2*L2)
% Third stretch
s<3*L1+3*L2)
% Third corner
s<4*L1+3*L2)
% Fourth stretch
s<4*L1+4*L2)
% Fourth corner

Reference values for tool tip position and velocities are fed to
inverse Jacobian and inverse kinematics to configure the joint
angular movements .
Implementation of controllers in Labview

P_L2

PI_L2

P_L3
PI_L3

Propotional Gain
(P)

Integral Gain
(I)

P_L2 & P_L3

50

-

PI_L2 & PI_L3

0.05

0.001
Harware-In-Loop;Labview,PLC
& Real Time Target

TCP/IP configuration

Data Communication
Communication between Step7 and Labview
Configuration of the PLC

Siemens ET200S PLC
Configuration of the PLC
Tasks of digital switches in PLC
Switch

Addre
Task
ss in
PLC
Manual(Man_Sw) I3.0
Tool tip is moved to any location in the xz plane with
respect to the actuator velocities given by analog inputs
Point(Point_Sw)

I3.2

Tool tip is moved through the shortest path from current
location to any given target location by changing the
velocity given by analog input 1

Auto(Auto_Sw)

I3.1

It is required to enable the point switch before enabling
the auto switch. Due to the limitation in actuator lengths,
it is not possible to run the given reference path starting
from any arbitrary location in the xz plane. Hence, the tool
tip is firstly moved to a defined point (2.0, 1.5) which is
within the scope of controlling the actuator lengths.
Thereafter, the tool tip is moved along the reference tool
tip path by enabling auto switch. Velocity of the tool tip
can be controlled by changing the analog input 1.
Digital switch configuration
Manual

Auto

Point

Output

1

1

1

No operation

1

1

0

No operation

1

0

1

No operation

1

0

0

0

1

1

Manual switch is
enabled
No operation

0

1

0

Auto switch is enabled

0

0

1

Point switch is enabled

0

0

0

No operation
Digital switch configuration in main
controller block with SCL

Manual-1 Auto-1 Point-1
Manual-1 Auto-1 Point-0

Manual-1 Auto-0 Point-1
Manual-1 Auto-0 Point-0
Manual-0 Auto-1 Point-1
Manual-0 Auto-1 Point-0
Manual-0 Auto-0 Point-1
Manual-0 Auto-0 Point-0
Implementation of the point switch in Step 7
 In order to achieve
the task of the
point switch,
point initializer
block and the
respective SCL
code is developed
 The Initial
Integrator block is
used to calculate
the distance ‘ss’,
travelled by tool
tip along the
linear reference
path from stating
point to target
point
Implementation of auto switch in Step 7

 ‘path’ function is defined to configure the reference tool tip position and
reference velocity.
 The reference tool path is implemented in Step 7 in SCL language
 An integrator is used to calculate the distance travelled by tool tip along
the reference path, ‘s’.
Crane kinematics and PID controllers in Step 7
 Inverse kinematics, Inverse jacobian and
actuator kinematics are developed in Step
seven as FC blocks and the same programs
used in labview were implemented in SCL
language.
 Two P controllers and two PI controllers were
implemented with CONT_C block and
parameters were tuned accordingly.

Controller
P_L2
P_L3
PI_L2Dot
PI_L3Dot

400
400
0.05
0.05

Tuned values
P
I
0
0
0.01
0.01
LabView Results: Path

 Test was sucessful
 Maximum +/- 10 cm
deviation form
expected path
Reference Path

Actual Path
LabView Results: Controllers Operation

Actuator L2 position and velocity controllers

Actuator L3 position and velocity controllers
HiL Test Results: Expected Path
HiL Test Results : Manual and Start Point
Initialization Operations
 Manual and tip point initialize(shortest path finder) control functions
to make the system operation more robust and safe.

Manual Mode Operation

Start Point Initialization Operations
HiL Test Results: Path
 HiL test was very sucessful
 Maximum +/-5 cm deviation form expected path( only in two edges).

Start Point Initialization Operations

Auto mode Actual Path
Real HMF Crane Test Results: Path
 Real crane test was very sucessful
 Maximum +/- 5 cm error in expected path
 Approximate 35 cm offset in x direction.

HiL Test Actual Path

Real Test Actual Path
Why 35 cm Offset ?
There is 34.3 cm offset in x direction
of the coordinate systems used in dll
file and real crane.
Discussion and Conclusions

 Lab view results were observed with +/- 5-10 cm deviation.
 Possible resons could be computer programs were not used dedicated
hardware to run controllers and DLL model.
 Modelling errors in DLL file and our sysem model
 With HIL test we used dedicated hardware to run the controllers and
realtime tartget(DLL model). Maximum +/-5 cm deviation form expected
path( only in two edges) was observed. HiL Test was very sucessful.
 Modelling errors in DLL file and our sysem model
 With real experiment it was observed Maximum +/- 5 cm error in
expected path and 35 cm offset in x direction. Test was very successful.
 Modelling errors in our system model.
 There seems 35 cm offset in x direction of DLL model output than real
crane. We could solve this problem with little modification in system.
Discussion and Conclusions (Cont.)
Solution to the offshore load transfer system
 2D -> 3D Solution
 Reference target is required to get from sensors of floating platform

Tool tip target tracking operation
Discussion and Conclusions (Cont..)
A real engineering experience with 3 steps..

1) Numarial Modeling/Simulation :
 Make the system with more software models(Lab view, dll model)
 Less acuarate but easy to change and think.
2) HiL Method:
 Make the sysem with more real equipments (PLC and switches) and
improved model sysems (DLL model run on real time labview,
Simulink model)
 More acurate results and closer to reality.
 It is cost saving safe method, befoure doing the actual task.
 sucess of this method highly depend on acuracy of real system model.
Here the given DLL model was acurate as the real machine works
accordingly.
3) Real world test with actual devices (PLC, HMF real crane and real switches)
 Solve the real world problem of offshore load transfer system
Thank You..!!

More Related Content

What's hot

DC servomechanism parameter identification a closed loop input error approach
DC servomechanism parameter identification a closed loop input error approachDC servomechanism parameter identification a closed loop input error approach
DC servomechanism parameter identification a closed loop input error approachISA Interchange
 
control system Lab 01-introduction to transfer functions
control system Lab 01-introduction to transfer functionscontrol system Lab 01-introduction to transfer functions
control system Lab 01-introduction to transfer functionsnalan karunanayake
 
Simulation and experimental study on PID control of a quadrotor MAV with pert...
Simulation and experimental study on PID control of a quadrotor MAV with pert...Simulation and experimental study on PID control of a quadrotor MAV with pert...
Simulation and experimental study on PID control of a quadrotor MAV with pert...journalBEEI
 
ROBOT HYBRID AND FORCE CONTROL IN MULTI-MICROPROCESSOR SYSTEM
ROBOT HYBRID AND FORCE CONTROL IN MULTI-MICROPROCESSOR SYSTEM ROBOT HYBRID AND FORCE CONTROL IN MULTI-MICROPROCESSOR SYSTEM
ROBOT HYBRID AND FORCE CONTROL IN MULTI-MICROPROCESSOR SYSTEM AnuShka Yadav
 
Design and development of matlab gui based fuzzy logic controllers for ac motor
Design and development of matlab gui based fuzzy logic controllers for ac motorDesign and development of matlab gui based fuzzy logic controllers for ac motor
Design and development of matlab gui based fuzzy logic controllers for ac motorIAEME Publication
 
Optimal and pid controller for controlling camera’s position in unmanned aeri...
Optimal and pid controller for controlling camera’s position in unmanned aeri...Optimal and pid controller for controlling camera’s position in unmanned aeri...
Optimal and pid controller for controlling camera’s position in unmanned aeri...Zac Darcy
 
R&D of Equipment
R&D of EquipmentR&D of Equipment
R&D of EquipmentTomoya Ito
 
implementation and design of 32-bit adder
implementation and design of 32-bit adderimplementation and design of 32-bit adder
implementation and design of 32-bit adderveereshwararao
 
Simulation design of trajectory planning robot manipulator
Simulation design of trajectory planning robot manipulatorSimulation design of trajectory planning robot manipulator
Simulation design of trajectory planning robot manipulatorjournalBEEI
 
New controllers efficient model based design method
New controllers efficient model based design methodNew controllers efficient model based design method
New controllers efficient model based design methodAlexander Decker
 
Portofolio Control Version SN
Portofolio Control Version SNPortofolio Control Version SN
Portofolio Control Version SNSamuel Narcisse
 
Design and Implementation of DC Motor Speed Control using Fuzzy Logic
Design and Implementation of DC Motor Speed Control using Fuzzy LogicDesign and Implementation of DC Motor Speed Control using Fuzzy Logic
Design and Implementation of DC Motor Speed Control using Fuzzy LogicWaleed El-Badry
 
Basic Control System unit6
Basic Control System unit6Basic Control System unit6
Basic Control System unit6Asraf Malik
 
PID Controller Design for a Real Time Ball and Beam System – A Double Integra...
PID Controller Design for a Real Time Ball and Beam System – A Double Integra...PID Controller Design for a Real Time Ball and Beam System – A Double Integra...
PID Controller Design for a Real Time Ball and Beam System – A Double Integra...idescitation
 
Lecture 13 ME 176 6 Steady State Error Re
Lecture 13 ME 176 6 Steady State Error ReLecture 13 ME 176 6 Steady State Error Re
Lecture 13 ME 176 6 Steady State Error ReLeonides De Ocampo
 

What's hot (18)

DC servomechanism parameter identification a closed loop input error approach
DC servomechanism parameter identification a closed loop input error approachDC servomechanism parameter identification a closed loop input error approach
DC servomechanism parameter identification a closed loop input error approach
 
Elevator1
Elevator1Elevator1
Elevator1
 
control system Lab 01-introduction to transfer functions
control system Lab 01-introduction to transfer functionscontrol system Lab 01-introduction to transfer functions
control system Lab 01-introduction to transfer functions
 
Simulation and experimental study on PID control of a quadrotor MAV with pert...
Simulation and experimental study on PID control of a quadrotor MAV with pert...Simulation and experimental study on PID control of a quadrotor MAV with pert...
Simulation and experimental study on PID control of a quadrotor MAV with pert...
 
Ball and beam
Ball and beamBall and beam
Ball and beam
 
Jw3417821791
Jw3417821791Jw3417821791
Jw3417821791
 
ROBOT HYBRID AND FORCE CONTROL IN MULTI-MICROPROCESSOR SYSTEM
ROBOT HYBRID AND FORCE CONTROL IN MULTI-MICROPROCESSOR SYSTEM ROBOT HYBRID AND FORCE CONTROL IN MULTI-MICROPROCESSOR SYSTEM
ROBOT HYBRID AND FORCE CONTROL IN MULTI-MICROPROCESSOR SYSTEM
 
Design and development of matlab gui based fuzzy logic controllers for ac motor
Design and development of matlab gui based fuzzy logic controllers for ac motorDesign and development of matlab gui based fuzzy logic controllers for ac motor
Design and development of matlab gui based fuzzy logic controllers for ac motor
 
Optimal and pid controller for controlling camera’s position in unmanned aeri...
Optimal and pid controller for controlling camera’s position in unmanned aeri...Optimal and pid controller for controlling camera’s position in unmanned aeri...
Optimal and pid controller for controlling camera’s position in unmanned aeri...
 
R&D of Equipment
R&D of EquipmentR&D of Equipment
R&D of Equipment
 
implementation and design of 32-bit adder
implementation and design of 32-bit adderimplementation and design of 32-bit adder
implementation and design of 32-bit adder
 
Simulation design of trajectory planning robot manipulator
Simulation design of trajectory planning robot manipulatorSimulation design of trajectory planning robot manipulator
Simulation design of trajectory planning robot manipulator
 
New controllers efficient model based design method
New controllers efficient model based design methodNew controllers efficient model based design method
New controllers efficient model based design method
 
Portofolio Control Version SN
Portofolio Control Version SNPortofolio Control Version SN
Portofolio Control Version SN
 
Design and Implementation of DC Motor Speed Control using Fuzzy Logic
Design and Implementation of DC Motor Speed Control using Fuzzy LogicDesign and Implementation of DC Motor Speed Control using Fuzzy Logic
Design and Implementation of DC Motor Speed Control using Fuzzy Logic
 
Basic Control System unit6
Basic Control System unit6Basic Control System unit6
Basic Control System unit6
 
PID Controller Design for a Real Time Ball and Beam System – A Double Integra...
PID Controller Design for a Real Time Ball and Beam System – A Double Integra...PID Controller Design for a Real Time Ball and Beam System – A Double Integra...
PID Controller Design for a Real Time Ball and Beam System – A Double Integra...
 
Lecture 13 ME 176 6 Steady State Error Re
Lecture 13 ME 176 6 Steady State Error ReLecture 13 ME 176 6 Steady State Error Re
Lecture 13 ME 176 6 Steady State Error Re
 

Viewers also liked

Design of wind turbine controllers in simulation x jagath_ireshika_bernad_dim...
Design of wind turbine controllers in simulation x jagath_ireshika_bernad_dim...Design of wind turbine controllers in simulation x jagath_ireshika_bernad_dim...
Design of wind turbine controllers in simulation x jagath_ireshika_bernad_dim...Dimuthu Darshana
 
Making anodes for solid oxide fuel cells Dimuthu Dharshana Kodippili Arachchige
Making anodes for solid oxide fuel cells Dimuthu Dharshana Kodippili ArachchigeMaking anodes for solid oxide fuel cells Dimuthu Dharshana Kodippili Arachchige
Making anodes for solid oxide fuel cells Dimuthu Dharshana Kodippili ArachchigeDimuthu Darshana
 
Dimuthu dharshana usb wirefire hdmi
Dimuthu dharshana usb wirefire hdmiDimuthu dharshana usb wirefire hdmi
Dimuthu dharshana usb wirefire hdmiDimuthu Darshana
 
Huis Grobler Power Point
Huis Grobler Power PointHuis Grobler Power Point
Huis Grobler Power Pointwsenta
 
Modelling and simulation of SAS system with MR damper Dimuthu Dharshana
Modelling and  simulation of SAS system with MR damper Dimuthu Dharshana Modelling and  simulation of SAS system with MR damper Dimuthu Dharshana
Modelling and simulation of SAS system with MR damper Dimuthu Dharshana Dimuthu Darshana
 
Internship oral presentation
Internship oral presentationInternship oral presentation
Internship oral presentationAnh-Mai
 
Quick DFT tour of Electron Energy Loss Spectrum (EELS)
Quick DFT tour of Electron Energy Loss  Spectrum (EELS)Quick DFT tour of Electron Energy Loss  Spectrum (EELS)
Quick DFT tour of Electron Energy Loss Spectrum (EELS)Shruba Gangopadhyay Ph.D.
 
Introduction to Nanotechnology K.A. Dimuthu Dharshana
Introduction to Nanotechnology K.A. Dimuthu DharshanaIntroduction to Nanotechnology K.A. Dimuthu Dharshana
Introduction to Nanotechnology K.A. Dimuthu DharshanaDimuthu Darshana
 
Solid Oxide Fuel Cells Presentation
Solid Oxide Fuel Cells PresentationSolid Oxide Fuel Cells Presentation
Solid Oxide Fuel Cells PresentationFarbod Moghadam
 
Design small scale wind turbine for home electricity generation
Design small scale wind turbine for home electricity generationDesign small scale wind turbine for home electricity generation
Design small scale wind turbine for home electricity generationMaheemal Thilakarathna
 
Free Download Powerpoint Slides
Free Download Powerpoint SlidesFree Download Powerpoint Slides
Free Download Powerpoint SlidesGeorge
 

Viewers also liked (17)

Design of wind turbine controllers in simulation x jagath_ireshika_bernad_dim...
Design of wind turbine controllers in simulation x jagath_ireshika_bernad_dim...Design of wind turbine controllers in simulation x jagath_ireshika_bernad_dim...
Design of wind turbine controllers in simulation x jagath_ireshika_bernad_dim...
 
Making anodes for solid oxide fuel cells Dimuthu Dharshana Kodippili Arachchige
Making anodes for solid oxide fuel cells Dimuthu Dharshana Kodippili ArachchigeMaking anodes for solid oxide fuel cells Dimuthu Dharshana Kodippili Arachchige
Making anodes for solid oxide fuel cells Dimuthu Dharshana Kodippili Arachchige
 
Dimuthu dharshana usb wirefire hdmi
Dimuthu dharshana usb wirefire hdmiDimuthu dharshana usb wirefire hdmi
Dimuthu dharshana usb wirefire hdmi
 
Huis Grobler Power Point
Huis Grobler Power PointHuis Grobler Power Point
Huis Grobler Power Point
 
Modelling and simulation of SAS system with MR damper Dimuthu Dharshana
Modelling and  simulation of SAS system with MR damper Dimuthu Dharshana Modelling and  simulation of SAS system with MR damper Dimuthu Dharshana
Modelling and simulation of SAS system with MR damper Dimuthu Dharshana
 
Internship oral presentation
Internship oral presentationInternship oral presentation
Internship oral presentation
 
93 pooja
93 pooja93 pooja
93 pooja
 
Quick DFT tour of Electron Energy Loss Spectrum (EELS)
Quick DFT tour of Electron Energy Loss  Spectrum (EELS)Quick DFT tour of Electron Energy Loss  Spectrum (EELS)
Quick DFT tour of Electron Energy Loss Spectrum (EELS)
 
SOFC perovskite- DFT work
SOFC perovskite- DFT workSOFC perovskite- DFT work
SOFC perovskite- DFT work
 
Introduction to Nanotechnology K.A. Dimuthu Dharshana
Introduction to Nanotechnology K.A. Dimuthu DharshanaIntroduction to Nanotechnology K.A. Dimuthu Dharshana
Introduction to Nanotechnology K.A. Dimuthu Dharshana
 
Solid Oxide Fuel Cells Presentation
Solid Oxide Fuel Cells PresentationSolid Oxide Fuel Cells Presentation
Solid Oxide Fuel Cells Presentation
 
SOLID OXIDE FUEL CELLS
SOLID OXIDE FUEL CELLSSOLID OXIDE FUEL CELLS
SOLID OXIDE FUEL CELLS
 
329 Kandavel
329 Kandavel329 Kandavel
329 Kandavel
 
MASc Research work
MASc Research workMASc Research work
MASc Research work
 
Fuel Cells
Fuel CellsFuel Cells
Fuel Cells
 
Design small scale wind turbine for home electricity generation
Design small scale wind turbine for home electricity generationDesign small scale wind turbine for home electricity generation
Design small scale wind turbine for home electricity generation
 
Free Download Powerpoint Slides
Free Download Powerpoint SlidesFree Download Powerpoint Slides
Free Download Powerpoint Slides
 

Similar to Design, Analysis and Control of an Offshore Load Transfer System

IMPLEMENTATION OF FRACTIONAL ORDER TRANSFER FUNCTION USING LOW COST DSP
IMPLEMENTATION OF FRACTIONAL ORDER TRANSFER FUNCTION USING LOW COST DSPIMPLEMENTATION OF FRACTIONAL ORDER TRANSFER FUNCTION USING LOW COST DSP
IMPLEMENTATION OF FRACTIONAL ORDER TRANSFER FUNCTION USING LOW COST DSPIAEME Publication
 
IRJET- Design and Fabrication of PLC and SCADA based Robotic Arm for Material...
IRJET- Design and Fabrication of PLC and SCADA based Robotic Arm for Material...IRJET- Design and Fabrication of PLC and SCADA based Robotic Arm for Material...
IRJET- Design and Fabrication of PLC and SCADA based Robotic Arm for Material...IRJET Journal
 
BallCatchingRobot
BallCatchingRobotBallCatchingRobot
BallCatchingRobotgauravbrd
 
International Journal of Computational Engineering Research(IJCER)
International Journal of Computational Engineering Research(IJCER)International Journal of Computational Engineering Research(IJCER)
International Journal of Computational Engineering Research(IJCER)ijceronline
 
Design and control of steam flow in cement production process using neural ne...
Design and control of steam flow in cement production process using neural ne...Design and control of steam flow in cement production process using neural ne...
Design and control of steam flow in cement production process using neural ne...Mustefa Jibril
 
Raymond.Brunkow-Project-EEL-3657-Sp15
Raymond.Brunkow-Project-EEL-3657-Sp15Raymond.Brunkow-Project-EEL-3657-Sp15
Raymond.Brunkow-Project-EEL-3657-Sp15Raymond Brunkow
 
Unity Feedback PD Controller Design for an Electronic Throttle Body
Unity Feedback PD Controller Design for an Electronic Throttle BodyUnity Feedback PD Controller Design for an Electronic Throttle Body
Unity Feedback PD Controller Design for an Electronic Throttle BodySteven Ernst, PE
 
BESCK104D_EME Module 5.pptx
BESCK104D_EME Module 5.pptxBESCK104D_EME Module 5.pptx
BESCK104D_EME Module 5.pptxManjunathtv2
 
Design and Implementation of Robot Arm Control Using LabVIEW and ARM Controller
Design and Implementation of Robot Arm Control Using LabVIEW and ARM ControllerDesign and Implementation of Robot Arm Control Using LabVIEW and ARM Controller
Design and Implementation of Robot Arm Control Using LabVIEW and ARM ControllerIOSR Journals
 
Industrial Automated Robots Working and explanation
Industrial Automated Robots Working and explanationIndustrial Automated Robots Working and explanation
Industrial Automated Robots Working and explanationSarmadFarooq5
 
06. industrial robotics
06. industrial robotics06. industrial robotics
06. industrial roboticsrichard visey
 
IRJET- Design & Development of Two-Wheeled Self Balancing Robot
IRJET-  	  Design & Development of Two-Wheeled Self Balancing RobotIRJET-  	  Design & Development of Two-Wheeled Self Balancing Robot
IRJET- Design & Development of Two-Wheeled Self Balancing RobotIRJET Journal
 
Optimal and Pid Controller for Controlling Camera's Position InUnmanned Aeria...
Optimal and Pid Controller for Controlling Camera's Position InUnmanned Aeria...Optimal and Pid Controller for Controlling Camera's Position InUnmanned Aeria...
Optimal and Pid Controller for Controlling Camera's Position InUnmanned Aeria...Zac Darcy
 
A Design Of Omni-Directional Mobile Robot Based On Mecanum Wheels
A Design Of Omni-Directional Mobile Robot Based On Mecanum WheelsA Design Of Omni-Directional Mobile Robot Based On Mecanum Wheels
A Design Of Omni-Directional Mobile Robot Based On Mecanum WheelsIJRESJOURNAL
 
Chapter 8 - Robot Control System
Chapter 8 - Robot Control SystemChapter 8 - Robot Control System
Chapter 8 - Robot Control SystemHaffiz Radzi
 
Paper id 24201493
Paper id 24201493Paper id 24201493
Paper id 24201493IJRAT
 
Design and Implementation of Model Reference Adaptive Controller using Coeffi...
Design and Implementation of Model Reference Adaptive Controller using Coeffi...Design and Implementation of Model Reference Adaptive Controller using Coeffi...
Design and Implementation of Model Reference Adaptive Controller using Coeffi...IOSR Journals
 

Similar to Design, Analysis and Control of an Offshore Load Transfer System (20)

IMPLEMENTATION OF FRACTIONAL ORDER TRANSFER FUNCTION USING LOW COST DSP
IMPLEMENTATION OF FRACTIONAL ORDER TRANSFER FUNCTION USING LOW COST DSPIMPLEMENTATION OF FRACTIONAL ORDER TRANSFER FUNCTION USING LOW COST DSP
IMPLEMENTATION OF FRACTIONAL ORDER TRANSFER FUNCTION USING LOW COST DSP
 
IRJET- Design and Fabrication of PLC and SCADA based Robotic Arm for Material...
IRJET- Design and Fabrication of PLC and SCADA based Robotic Arm for Material...IRJET- Design and Fabrication of PLC and SCADA based Robotic Arm for Material...
IRJET- Design and Fabrication of PLC and SCADA based Robotic Arm for Material...
 
BallCatchingRobot
BallCatchingRobotBallCatchingRobot
BallCatchingRobot
 
International Journal of Computational Engineering Research(IJCER)
International Journal of Computational Engineering Research(IJCER)International Journal of Computational Engineering Research(IJCER)
International Journal of Computational Engineering Research(IJCER)
 
Design and control of steam flow in cement production process using neural ne...
Design and control of steam flow in cement production process using neural ne...Design and control of steam flow in cement production process using neural ne...
Design and control of steam flow in cement production process using neural ne...
 
Raymond.Brunkow-Project-EEL-3657-Sp15
Raymond.Brunkow-Project-EEL-3657-Sp15Raymond.Brunkow-Project-EEL-3657-Sp15
Raymond.Brunkow-Project-EEL-3657-Sp15
 
Unity Feedback PD Controller Design for an Electronic Throttle Body
Unity Feedback PD Controller Design for an Electronic Throttle BodyUnity Feedback PD Controller Design for an Electronic Throttle Body
Unity Feedback PD Controller Design for an Electronic Throttle Body
 
Industrial robotics.pptx
Industrial robotics.pptxIndustrial robotics.pptx
Industrial robotics.pptx
 
BESCK104D_EME Module 5.pptx
BESCK104D_EME Module 5.pptxBESCK104D_EME Module 5.pptx
BESCK104D_EME Module 5.pptx
 
Design and Implementation of Robot Arm Control Using LabVIEW and ARM Controller
Design and Implementation of Robot Arm Control Using LabVIEW and ARM ControllerDesign and Implementation of Robot Arm Control Using LabVIEW and ARM Controller
Design and Implementation of Robot Arm Control Using LabVIEW and ARM Controller
 
Industrial Automated Robots Working and explanation
Industrial Automated Robots Working and explanationIndustrial Automated Robots Working and explanation
Industrial Automated Robots Working and explanation
 
06. industrial robotics
06. industrial robotics06. industrial robotics
06. industrial robotics
 
IRJET- Design & Development of Two-Wheeled Self Balancing Robot
IRJET-  	  Design & Development of Two-Wheeled Self Balancing RobotIRJET-  	  Design & Development of Two-Wheeled Self Balancing Robot
IRJET- Design & Development of Two-Wheeled Self Balancing Robot
 
SEM 6th final 1
SEM 6th final 1SEM 6th final 1
SEM 6th final 1
 
Optimal and Pid Controller for Controlling Camera's Position InUnmanned Aeria...
Optimal and Pid Controller for Controlling Camera's Position InUnmanned Aeria...Optimal and Pid Controller for Controlling Camera's Position InUnmanned Aeria...
Optimal and Pid Controller for Controlling Camera's Position InUnmanned Aeria...
 
A Design Of Omni-Directional Mobile Robot Based On Mecanum Wheels
A Design Of Omni-Directional Mobile Robot Based On Mecanum WheelsA Design Of Omni-Directional Mobile Robot Based On Mecanum Wheels
A Design Of Omni-Directional Mobile Robot Based On Mecanum Wheels
 
Chapter 8 - Robot Control System
Chapter 8 - Robot Control SystemChapter 8 - Robot Control System
Chapter 8 - Robot Control System
 
Paper id 24201493
Paper id 24201493Paper id 24201493
Paper id 24201493
 
Design and Implementation of Model Reference Adaptive Controller using Coeffi...
Design and Implementation of Model Reference Adaptive Controller using Coeffi...Design and Implementation of Model Reference Adaptive Controller using Coeffi...
Design and Implementation of Model Reference Adaptive Controller using Coeffi...
 
F05613947
F05613947F05613947
F05613947
 

Recently uploaded

"Subclassing and Composition – A Pythonic Tour of Trade-Offs", Hynek Schlawack
"Subclassing and Composition – A Pythonic Tour of Trade-Offs", Hynek Schlawack"Subclassing and Composition – A Pythonic Tour of Trade-Offs", Hynek Schlawack
"Subclassing and Composition – A Pythonic Tour of Trade-Offs", Hynek SchlawackFwdays
 
"Debugging python applications inside k8s environment", Andrii Soldatenko
"Debugging python applications inside k8s environment", Andrii Soldatenko"Debugging python applications inside k8s environment", Andrii Soldatenko
"Debugging python applications inside k8s environment", Andrii SoldatenkoFwdays
 
Transcript: New from BookNet Canada for 2024: BNC CataList - Tech Forum 2024
Transcript: New from BookNet Canada for 2024: BNC CataList - Tech Forum 2024Transcript: New from BookNet Canada for 2024: BNC CataList - Tech Forum 2024
Transcript: New from BookNet Canada for 2024: BNC CataList - Tech Forum 2024BookNet Canada
 
Install Stable Diffusion in windows machine
Install Stable Diffusion in windows machineInstall Stable Diffusion in windows machine
Install Stable Diffusion in windows machinePadma Pradeep
 
Advanced Test Driven-Development @ php[tek] 2024
Advanced Test Driven-Development @ php[tek] 2024Advanced Test Driven-Development @ php[tek] 2024
Advanced Test Driven-Development @ php[tek] 2024Scott Keck-Warren
 
SIP trunking in Janus @ Kamailio World 2024
SIP trunking in Janus @ Kamailio World 2024SIP trunking in Janus @ Kamailio World 2024
SIP trunking in Janus @ Kamailio World 2024Lorenzo Miniero
 
Powerpoint exploring the locations used in television show Time Clash
Powerpoint exploring the locations used in television show Time ClashPowerpoint exploring the locations used in television show Time Clash
Powerpoint exploring the locations used in television show Time Clashcharlottematthew16
 
WordPress Websites for Engineers: Elevate Your Brand
WordPress Websites for Engineers: Elevate Your BrandWordPress Websites for Engineers: Elevate Your Brand
WordPress Websites for Engineers: Elevate Your Brandgvaughan
 
Nell’iperspazio con Rocket: il Framework Web di Rust!
Nell’iperspazio con Rocket: il Framework Web di Rust!Nell’iperspazio con Rocket: il Framework Web di Rust!
Nell’iperspazio con Rocket: il Framework Web di Rust!Commit University
 
Tampa BSides - Chef's Tour of Microsoft Security Adoption Framework (SAF)
Tampa BSides - Chef's Tour of Microsoft Security Adoption Framework (SAF)Tampa BSides - Chef's Tour of Microsoft Security Adoption Framework (SAF)
Tampa BSides - Chef's Tour of Microsoft Security Adoption Framework (SAF)Mark Simos
 
DevEX - reference for building teams, processes, and platforms
DevEX - reference for building teams, processes, and platformsDevEX - reference for building teams, processes, and platforms
DevEX - reference for building teams, processes, and platformsSergiu Bodiu
 
Are Multi-Cloud and Serverless Good or Bad?
Are Multi-Cloud and Serverless Good or Bad?Are Multi-Cloud and Serverless Good or Bad?
Are Multi-Cloud and Serverless Good or Bad?Mattias Andersson
 
SAP Build Work Zone - Overview L2-L3.pptx
SAP Build Work Zone - Overview L2-L3.pptxSAP Build Work Zone - Overview L2-L3.pptx
SAP Build Work Zone - Overview L2-L3.pptxNavinnSomaal
 
"ML in Production",Oleksandr Bagan
"ML in Production",Oleksandr Bagan"ML in Production",Oleksandr Bagan
"ML in Production",Oleksandr BaganFwdays
 
Anypoint Exchange: It’s Not Just a Repo!
Anypoint Exchange: It’s Not Just a Repo!Anypoint Exchange: It’s Not Just a Repo!
Anypoint Exchange: It’s Not Just a Repo!Manik S Magar
 
Leverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage Cost
Leverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage CostLeverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage Cost
Leverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage CostZilliz
 
Artificial intelligence in cctv survelliance.pptx
Artificial intelligence in cctv survelliance.pptxArtificial intelligence in cctv survelliance.pptx
Artificial intelligence in cctv survelliance.pptxhariprasad279825
 
What's New in Teams Calling, Meetings and Devices March 2024
What's New in Teams Calling, Meetings and Devices March 2024What's New in Teams Calling, Meetings and Devices March 2024
What's New in Teams Calling, Meetings and Devices March 2024Stephanie Beckett
 
My INSURER PTE LTD - Insurtech Innovation Award 2024
My INSURER PTE LTD - Insurtech Innovation Award 2024My INSURER PTE LTD - Insurtech Innovation Award 2024
My INSURER PTE LTD - Insurtech Innovation Award 2024The Digital Insurer
 

Recently uploaded (20)

"Subclassing and Composition – A Pythonic Tour of Trade-Offs", Hynek Schlawack
"Subclassing and Composition – A Pythonic Tour of Trade-Offs", Hynek Schlawack"Subclassing and Composition – A Pythonic Tour of Trade-Offs", Hynek Schlawack
"Subclassing and Composition – A Pythonic Tour of Trade-Offs", Hynek Schlawack
 
"Debugging python applications inside k8s environment", Andrii Soldatenko
"Debugging python applications inside k8s environment", Andrii Soldatenko"Debugging python applications inside k8s environment", Andrii Soldatenko
"Debugging python applications inside k8s environment", Andrii Soldatenko
 
Transcript: New from BookNet Canada for 2024: BNC CataList - Tech Forum 2024
Transcript: New from BookNet Canada for 2024: BNC CataList - Tech Forum 2024Transcript: New from BookNet Canada for 2024: BNC CataList - Tech Forum 2024
Transcript: New from BookNet Canada for 2024: BNC CataList - Tech Forum 2024
 
Install Stable Diffusion in windows machine
Install Stable Diffusion in windows machineInstall Stable Diffusion in windows machine
Install Stable Diffusion in windows machine
 
DMCC Future of Trade Web3 - Special Edition
DMCC Future of Trade Web3 - Special EditionDMCC Future of Trade Web3 - Special Edition
DMCC Future of Trade Web3 - Special Edition
 
Advanced Test Driven-Development @ php[tek] 2024
Advanced Test Driven-Development @ php[tek] 2024Advanced Test Driven-Development @ php[tek] 2024
Advanced Test Driven-Development @ php[tek] 2024
 
SIP trunking in Janus @ Kamailio World 2024
SIP trunking in Janus @ Kamailio World 2024SIP trunking in Janus @ Kamailio World 2024
SIP trunking in Janus @ Kamailio World 2024
 
Powerpoint exploring the locations used in television show Time Clash
Powerpoint exploring the locations used in television show Time ClashPowerpoint exploring the locations used in television show Time Clash
Powerpoint exploring the locations used in television show Time Clash
 
WordPress Websites for Engineers: Elevate Your Brand
WordPress Websites for Engineers: Elevate Your BrandWordPress Websites for Engineers: Elevate Your Brand
WordPress Websites for Engineers: Elevate Your Brand
 
Nell’iperspazio con Rocket: il Framework Web di Rust!
Nell’iperspazio con Rocket: il Framework Web di Rust!Nell’iperspazio con Rocket: il Framework Web di Rust!
Nell’iperspazio con Rocket: il Framework Web di Rust!
 
Tampa BSides - Chef's Tour of Microsoft Security Adoption Framework (SAF)
Tampa BSides - Chef's Tour of Microsoft Security Adoption Framework (SAF)Tampa BSides - Chef's Tour of Microsoft Security Adoption Framework (SAF)
Tampa BSides - Chef's Tour of Microsoft Security Adoption Framework (SAF)
 
DevEX - reference for building teams, processes, and platforms
DevEX - reference for building teams, processes, and platformsDevEX - reference for building teams, processes, and platforms
DevEX - reference for building teams, processes, and platforms
 
Are Multi-Cloud and Serverless Good or Bad?
Are Multi-Cloud and Serverless Good or Bad?Are Multi-Cloud and Serverless Good or Bad?
Are Multi-Cloud and Serverless Good or Bad?
 
SAP Build Work Zone - Overview L2-L3.pptx
SAP Build Work Zone - Overview L2-L3.pptxSAP Build Work Zone - Overview L2-L3.pptx
SAP Build Work Zone - Overview L2-L3.pptx
 
"ML in Production",Oleksandr Bagan
"ML in Production",Oleksandr Bagan"ML in Production",Oleksandr Bagan
"ML in Production",Oleksandr Bagan
 
Anypoint Exchange: It’s Not Just a Repo!
Anypoint Exchange: It’s Not Just a Repo!Anypoint Exchange: It’s Not Just a Repo!
Anypoint Exchange: It’s Not Just a Repo!
 
Leverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage Cost
Leverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage CostLeverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage Cost
Leverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage Cost
 
Artificial intelligence in cctv survelliance.pptx
Artificial intelligence in cctv survelliance.pptxArtificial intelligence in cctv survelliance.pptx
Artificial intelligence in cctv survelliance.pptx
 
What's New in Teams Calling, Meetings and Devices March 2024
What's New in Teams Calling, Meetings and Devices March 2024What's New in Teams Calling, Meetings and Devices March 2024
What's New in Teams Calling, Meetings and Devices March 2024
 
My INSURER PTE LTD - Insurtech Innovation Award 2024
My INSURER PTE LTD - Insurtech Innovation Award 2024My INSURER PTE LTD - Insurtech Innovation Award 2024
My INSURER PTE LTD - Insurtech Innovation Award 2024
 

Design, Analysis and Control of an Offshore Load Transfer System

  • 1. Design, Analysis and Control of an Offshore Load Transfer System MAS501 Control Theory2- Autumn 2013 University of Agder Grimstad Norway Oreste Niyonsaba Haocheng Su Dimuthu Dharshana Arachchige Bernard Sisara Gunawardana Subodha Tharangi Ireshika Jagath Sri Lal Senanayaka
  • 2. Presentation Outline  Introduction and methodology  Crane kinematics  Control architecture in Labview  HIL Setup  Control architecture in Step 7  Results  Discussion and Conclusion
  • 3. Introduction and methodology  Cranes are used in different Engineering activities including offshore operations for transportation of loads and personnel.  Control design needs improvement to meet some of the main criteria such as automatic tool tip tracking among others  Control system is aimed at maintaining the position of the tool tip within one meter by one meter square relative to an inertial frame of measurement is developed  Firstly, the desired tool path is achieved in Labview, then the control architecture is programmed in Siemens Step7 TIA environment integrated with Siemens ET200 PLC.
  • 4. Introduction and methodology  Control Architecture is plugged with crane boom to achieve the desired movement  A DLL file is created by modeling HMF crane in SimulationX in order to use it in Labview software as shown if the figure below
  • 5. Introduction and methodology  The desire is to implement the control architecture with two P and PI controllers for controlling the tool tip position
  • 6. Crane kinematics from matlab  Kinematics plays a significient role to establish the traslational relastionships between global coordinate system and the coordinate system of crane components.  Devided in to Forward kinematics, Inverse kinematics, Forward Jacobian, Inverse Jacobian and Actuator kinematics
  • 7. Forward Kinematics  Utilized to find the change of tool tip position when the angular positions are given  Necessary to develop DH (Denavit-Hartenberg) table
  • 8. Inverse Kinematics  Utilized to sketch the angular position(q2,q3) when the tool tip position (x,z)is known.
  • 9. Forward Jacobian  Utilized to skecth the velocities of the actucators when the angular velocities are known.  Maple was used to find the parameters in the jacobian matrix.
  • 10. Inverse Jacobian  Angular velociteis when the toll tip velocities are known.  It is obtained by differentiating the inverse kinematics.  This part is also implemented in both matlab and labview.  Inverse kinematics and inverse Jacobian are crucial to convert the reference positions and velocities of the desired tool path into reference angular positions and angular velocities of two actuator joints.
  • 11. Actuator kinematics Used to derive relationships between angular movement of the actuators and linear movements of the cylinders. Actuator Kinematics 2 Actuator Kinematics 1 L3 L2 Law of Cosine Analytical procedures are difficult
  • 12. Polynomail Curve Fitting: ‘Polyfit’ Returns coefficients of the polynomial in descending powers. L2 and Q2 Relation L3 and Q3 Relation 140 40 120 20 100 0 80 -20 60 -40 40 -60 20 -80 0 -100 -20 -120 -40 -140 -60 1 1.1 1.2 1.3 1.4 1.5 1.6 1.7 1.8 1.9 2 -160 1.1 Root mean square error Third order polynomial Fifth order polynomial 1.2 1.3 1.4 1.5 1.6 0.0067 0.0037 1.7 1.8 1.9 2 2.1
  • 13. Tool path in Labview Operated in two segments The path length (L) between the two locations and angular position of the velocity vector are geometrically found in order to guide the tool tip along the shortest possible path 1. Initial position and target point 2. Reference square path
  • 14. Tool point along the reference square path Total Length of path s=3.914 m s<L1 % First stretch xDot=v; zDot=0; s<L1+L2 % First corner x=R+L1+R*cos(q-pi/2); z=R+R*sin(q-pi/2); xDot=v*cos(q); zDot=v*sin(q); s<2*L1+L2) % Second stretch s<2*L1+2*L2) % Second corner s<3*L1+2*L2) % Third stretch s<3*L1+3*L2) % Third corner s<4*L1+3*L2) % Fourth stretch s<4*L1+4*L2) % Fourth corner Reference values for tool tip position and velocities are fed to inverse Jacobian and inverse kinematics to configure the joint angular movements .
  • 15. Implementation of controllers in Labview P_L2 PI_L2 P_L3 PI_L3 Propotional Gain (P) Integral Gain (I) P_L2 & P_L3 50 - PI_L2 & PI_L3 0.05 0.001
  • 16. Harware-In-Loop;Labview,PLC & Real Time Target TCP/IP configuration Data Communication
  • 18. Configuration of the PLC Siemens ET200S PLC
  • 20. Tasks of digital switches in PLC Switch Addre Task ss in PLC Manual(Man_Sw) I3.0 Tool tip is moved to any location in the xz plane with respect to the actuator velocities given by analog inputs Point(Point_Sw) I3.2 Tool tip is moved through the shortest path from current location to any given target location by changing the velocity given by analog input 1 Auto(Auto_Sw) I3.1 It is required to enable the point switch before enabling the auto switch. Due to the limitation in actuator lengths, it is not possible to run the given reference path starting from any arbitrary location in the xz plane. Hence, the tool tip is firstly moved to a defined point (2.0, 1.5) which is within the scope of controlling the actuator lengths. Thereafter, the tool tip is moved along the reference tool tip path by enabling auto switch. Velocity of the tool tip can be controlled by changing the analog input 1.
  • 21. Digital switch configuration Manual Auto Point Output 1 1 1 No operation 1 1 0 No operation 1 0 1 No operation 1 0 0 0 1 1 Manual switch is enabled No operation 0 1 0 Auto switch is enabled 0 0 1 Point switch is enabled 0 0 0 No operation
  • 22. Digital switch configuration in main controller block with SCL Manual-1 Auto-1 Point-1 Manual-1 Auto-1 Point-0 Manual-1 Auto-0 Point-1 Manual-1 Auto-0 Point-0 Manual-0 Auto-1 Point-1 Manual-0 Auto-1 Point-0 Manual-0 Auto-0 Point-1 Manual-0 Auto-0 Point-0
  • 23. Implementation of the point switch in Step 7  In order to achieve the task of the point switch, point initializer block and the respective SCL code is developed  The Initial Integrator block is used to calculate the distance ‘ss’, travelled by tool tip along the linear reference path from stating point to target point
  • 24. Implementation of auto switch in Step 7  ‘path’ function is defined to configure the reference tool tip position and reference velocity.  The reference tool path is implemented in Step 7 in SCL language  An integrator is used to calculate the distance travelled by tool tip along the reference path, ‘s’.
  • 25. Crane kinematics and PID controllers in Step 7  Inverse kinematics, Inverse jacobian and actuator kinematics are developed in Step seven as FC blocks and the same programs used in labview were implemented in SCL language.  Two P controllers and two PI controllers were implemented with CONT_C block and parameters were tuned accordingly. Controller P_L2 P_L3 PI_L2Dot PI_L3Dot 400 400 0.05 0.05 Tuned values P I 0 0 0.01 0.01
  • 26. LabView Results: Path  Test was sucessful  Maximum +/- 10 cm deviation form expected path Reference Path Actual Path
  • 27. LabView Results: Controllers Operation Actuator L2 position and velocity controllers Actuator L3 position and velocity controllers
  • 28. HiL Test Results: Expected Path
  • 29. HiL Test Results : Manual and Start Point Initialization Operations  Manual and tip point initialize(shortest path finder) control functions to make the system operation more robust and safe. Manual Mode Operation Start Point Initialization Operations
  • 30. HiL Test Results: Path  HiL test was very sucessful  Maximum +/-5 cm deviation form expected path( only in two edges). Start Point Initialization Operations Auto mode Actual Path
  • 31. Real HMF Crane Test Results: Path  Real crane test was very sucessful  Maximum +/- 5 cm error in expected path  Approximate 35 cm offset in x direction. HiL Test Actual Path Real Test Actual Path
  • 32. Why 35 cm Offset ? There is 34.3 cm offset in x direction of the coordinate systems used in dll file and real crane.
  • 33. Discussion and Conclusions  Lab view results were observed with +/- 5-10 cm deviation.  Possible resons could be computer programs were not used dedicated hardware to run controllers and DLL model.  Modelling errors in DLL file and our sysem model  With HIL test we used dedicated hardware to run the controllers and realtime tartget(DLL model). Maximum +/-5 cm deviation form expected path( only in two edges) was observed. HiL Test was very sucessful.  Modelling errors in DLL file and our sysem model  With real experiment it was observed Maximum +/- 5 cm error in expected path and 35 cm offset in x direction. Test was very successful.  Modelling errors in our system model.  There seems 35 cm offset in x direction of DLL model output than real crane. We could solve this problem with little modification in system.
  • 34. Discussion and Conclusions (Cont.) Solution to the offshore load transfer system  2D -> 3D Solution  Reference target is required to get from sensors of floating platform Tool tip target tracking operation
  • 35. Discussion and Conclusions (Cont..) A real engineering experience with 3 steps.. 1) Numarial Modeling/Simulation :  Make the system with more software models(Lab view, dll model)  Less acuarate but easy to change and think. 2) HiL Method:  Make the sysem with more real equipments (PLC and switches) and improved model sysems (DLL model run on real time labview, Simulink model)  More acurate results and closer to reality.  It is cost saving safe method, befoure doing the actual task.  sucess of this method highly depend on acuracy of real system model. Here the given DLL model was acurate as the real machine works accordingly. 3) Real world test with actual devices (PLC, HMF real crane and real switches)  Solve the real world problem of offshore load transfer system