SlideShare a Scribd company logo
1 of 11
Download to read offline
Resume
NAME
ANDIKA PRAMANTA YUDHA (ANDY)
EMAIL
ANDIKA.PRAMANTA.YUDHA@GMAIL.COM
SKYPE
DIKAYUDHA8
DATE OF BIRTH
OCTOBER 29TH, 1990
PERSONAL EXPERIENCENTUST Master graduated with
3.96 GPA. Interested in Humanoid
Robot, Unmanned Aerial Vehicle,
Delta Robot Manipulator, all kind
of Control System, and Embedded
System.
C# Programming Language
C++ Programming Language
JAVA Programming Language
MATLAB
Control Theory
Robotics (Humanoid, Delta Robot
Manipulator, UAV Quad rotor)
Embedded System (AVR and ARM)
CORE
COMPETENCIES
2011 2012 2013 2014 2015
Voltage and
Current
Measuring Device
Instrument
Indonesian
Payload Rocket
Competition
Project Approval
Website for PLN
UAV Quad rotor
Research
UAV Quad rotor
Research
Delta Robot
Manipulator
Project
Humanoid Teen
Size Project
Humanoid Teen
Size Project
Exoskeleton
Project
AWARDS
1 32ST PLACE ND PLACE RD PLACE
2015
Technical Challenge in Robocup,
international Humanoid Robot Soccer
Competition in Heifei, China
2011
International Robotic Olympiad,
Creative Robot category (using Quad
rotor and car robot) by IROC
(International Robotic Olympiad
Committee) in Jakarta, Indonesia
2015
Soccer Game Competition in
Robocup, international Humanoid
Robot Soccer Competition in Heifei,
China
2015
FIRA International Intelligent
Humanoid Robot Competition in
Kaohsiung, Taiwan
ST PLACE of Freshman Category
1 2014
Delta Robot Competition in National Taiwan University, Taipei, Taiwan
PORTFOLIO
DELTA ROBOT
This delta robot is made by NTUST Medical Robot
Laboratory Students for Delta Robot Competition
held in National Taiwan University in 2014. This
robot is actuated with 3 HIWIN AC motors to
move the end effector in 3D space, and
controlled using ARM STM32 Microcontroller. The
competition goal were to do the stamping as
many as the robot can, and also pick an object,
and move it along the trajectory which is decided
by the competition rule. This robot won the 1st
place of freshman category. The honor is posted
in front of Electrical and Electronic Engineering
building in NTUST.
TEEN-SIZE HUMANOID
The goal for the project was to create the teen
size humanoid robot which be able to walk, fall
down and stand up. This robot also can play
soccer. To achieve this goal, vision detection is
utilized to recognize the ball, and also make
decision about where to move the detected ball.
My part was to utilize the locomotion control so
that robot can walk. We used LIPM concept for
Hip trajectory and also maintain the robot’s
CoG(center of gravity). AHRS sensor was used
for robot walking stabilization, and also fall
detection to perform stand up procedure.
EXOSKELETON
My part of this project will be the leg control
using Regressor Free Adaptive Impedance
control as the compliance control, so that
the robot will be able to adapt based on
patient leg movement, and also Disturbance
observer to estimate external torque and
amplify it for the passive power assisted
exoskeleton.
QUADROTOR
BACHELOR THESIS, 2012
TOOLS
MBED WEB-COMPILER
ARDUINO IDE
MATLAB
METHOD
DCM FOR IMU
PID CONTROL
Multithreading
SENSORS
ACCELEROMETER
GYROSCOPE
MAGNETOMETER
DEVICES
ARM CORTEX M3
ARDUINO
2.4 GHz Wireless Remote
xbee
HOW IT WORKS
UART 1
PWM OUT(1-4)
PWMIN
UART2
ACTUATORS 4X
Brushless Motor
DC + ESC
USER INPUT
DEVICE
4 CHANNEL
REMOTE CONTROL
ACCELEROMETER
GYROSCOPE
MAGNETOMETER
XBEE
1. Remote Control Input will be the
desired inputs of Roll Pitch and Yaw
2. PID Control will be utilized to control
the attitude by calculate the error
from desired attitude from remote
control and ACCELEROMETER +
GYROSCOPE + MAGNETOMETER
3. ACCELEROMETER + GYROSCOPE +
MAGNETOMETER outputs will be
calculated using Direction Cosine
Matrix to reject noise and drift from
those sensors and forming 9 x 9
orientation matrix so the roll pitch
and yaw output could be obtained.
4. PID output will be the input for
brushless DC motors
5. Attitude data will be sent through
xbee for analyzing
Exoskeleton
MASTER THESIS AND TAIWAN NATIONAL SCIENCE COUNCIL PROJECT, 2015
TOOLS
Visual Studio 2015
SMART Motor Interface
MATLAB
METHOD
Adaptive control
Disturbance observer
Multithreading
SENSORS
POSITION ENCODER
VELOCITY ENCODER
DEVICES
STM32F429
(ARM CORTEX M3)
SMART MOTORS 4X
HOW IT WORKS
ACTIVE-ASSISTED EXOSKELETON
1. Exoskeleton will move based on the certain
trajectory, and the patient leg will follow the
movement.
2. The motor position and velocity will be sent
through serial communication from the motor
to microcontroller and control it using
ADAPTIVE CONTROL to follow the trajectory.
3. This control requires NO ACCELERATION
FEEDBACK and SYSTEM DYNAMIC
PASSIVE-ASSISTED EXOSKELETON
1. Position and Velocity from the motor will be red
as the input to measure external torque using
DISTURBANCE OBSERVER
2. The system will amplify the torque estimated to
assist the patient movement
3. Gravity compensation is needed to get rid of
gravity effect
ACTUATORS 4X
SMART MOTOR
With Position
and Velocity
Encoders Inside
UART1
UART2
USB
USB TO TTL FTDI
PC With Windows
Operating System
Exoskeleton
MASTER THESIS AND TAIWAN NATIONAL SCIENCE COUNCIL PROJECT, 2015
TOOLS
Visual Studio 2015
SMART Motor Interface
MATLAB
METHOD
Adaptive control
Disturbance observer
Multithreading
SENSORS
POSITION ENCODER
VELOCITY ENCODER
DEVICES
STM32F429
(ARM CORTEX M3)
SMART MOTORS 4X
Control System Diagram
Passive Assisted Exoskeleton
Active Assisted Exoskeleton
Gravity
compensation
Exoskeleton
Actuators
Disturbance
Observer
Human
K 𝑞, 𝑞
𝑔(𝑞)
𝜏ℎ
𝜏 𝑑
+
−
+
Motion
Planner
Adaptive
Control
Exoskeleton
Actuators
Disturbance
Observer
𝑞 𝑑
𝑞, 𝑞
𝑞
𝜏 𝑑
𝜏
𝜏+
−
+
+
+
Delta Robot
DELTA ROBOT EVOLUTION, 2014
TOOLS
Visual Studio 2015
SMART Motor Interface
MATLAB
METHOD
Adaptive control
Disturbance observer
Multithreading
SENSORS
POSITION ENCODER
VELOCITY ENCODER
DEVICES
STM32F429
(ARM CORTEX M3)
SMART MOTORS 4X
HOW IT WORKS
1. Trajectory of the end
effector is generated based
on the competition rule
2. Air gripper is used to grab
objects and move it to
certain position
3. Delta robot inverse kinematic
is used to get the desired
rotational position for 3 main
actuators
4. We used default PID position
control from motor driver
5. Communication from
microcontroller to AC Servo
motor driver is based on
pulse counter for desired
rotational position and pulse
frequency for the desired
speed.
ACTUATORS 3X
HIWIN AC SERVO
MOTOR
DigitalI/OPINs
UART1
USB
USB TO TTL FTDI
PC With Windows
Operating System
TEEN-SIZE HUMANOID
TAIWAN NATIONAL SCIENCE COUNCIL PROJECT, 2015
TOOLS
Arduino IDE
MATLAB
METHOD
LIPM
PD Control
SENSORS
Accelerometer
Gyroscope
Magnetometer
DEVICES
Arduino Mega
(ATMEGA 2560)
Dynamixel NX-106
Switch IC
HOW IT WORKS
1. LIPM is used to create the hip trajectory when
the robot perform omni-directional movement
2. Besides LIPM we also create foot trajectory.
Together with LIPM trajectory output, we
calculate the robot inverse kinematic to get
motor rotational position of Robot’s leg.
3. MX-106 dynamixel motor has its own PID control
for motor rotational position control.
4. Gyroscope is used to read and use PD control
stabilize the robot walking.
5. Using DCM algorithm, we calculate the robot
orientations and use them to detect whether the
robot falls down or still walking and perform
safety fall then stand up procedure if the robot
falls.
6. Using DCM, we can know robot position relative
to north direction, and we will use that
orientation to define the goalpost in soccer
competition.
UART 2I2C
USB
USB
IntelNUC Arduino Mega
Acc+gryo+
magneto
Actuators
13x
TEEN-SIZE HUMANOID
TAIWAN NATIONAL SCIENCE COUNCIL PROJECT, 2015
TOOLS
Arduino IDE
MATLAB
METHOD
LIPM
PD Control
SENSORS
Accelerometer
Gyroscope
Magnetometer
DEVICES
Arduino Mega
(ATMEGA 2560)
Dynamixel NX-106
Switch IC
LIPM
LIPM Zc
LIPM Gravity Init
LIPM Gravity
Final
Foot
Trajectory
∆𝜃
∆𝑥
∆𝑦
Inverse
Kinematic
Intel NUC
Power
Cutoff
Delay
Stand Up
Procedure
PD Control
Servo Motor
IMU
Vision
System
𝐹𝑜𝑜𝑡 𝑇𝑟𝑎𝑗𝑒𝑐𝑡𝑜𝑟𝑦
Parameters
𝐻𝑖𝑝 𝑇𝑟𝑎𝑗𝑒𝑐𝑡𝑜𝑟𝑦
𝐹𝑜𝑜𝑡 𝑇𝑟𝑎𝑗𝑒𝑐𝑡𝑜𝑟𝑦
+
+
LIPM
Parameters
SWITCH
SWITCH
Control System Overview
THANK YOU
FOR YOUR ATTENTION

More Related Content

What's hot

Wireless gesture controlled robot
Wireless gesture controlled robotWireless gesture controlled robot
Wireless gesture controlled robotVIBEK MAURYA
 
Real-time Obstacle Avoidance Algorithm for Mobile Robots
Real-time Obstacle Avoidance  Algorithm for Mobile RobotsReal-time Obstacle Avoidance  Algorithm for Mobile Robots
Real-time Obstacle Avoidance Algorithm for Mobile RobotsM. Jamiul Islam (Jamil)
 
Obstacle avoiding robot
Obstacle avoiding robotObstacle avoiding robot
Obstacle avoiding robotecwayerode
 
Wireless controlled robotic arm
Wireless controlled robotic armWireless controlled robotic arm
Wireless controlled robotic armmundaa
 
Gesture Controlled Car_Project report
Gesture Controlled Car_Project reportGesture Controlled Car_Project report
Gesture Controlled Car_Project reportAshikapokiya12345
 
Mainprojpresentation 150617092611-lva1-app6892
Mainprojpresentation 150617092611-lva1-app6892Mainprojpresentation 150617092611-lva1-app6892
Mainprojpresentation 150617092611-lva1-app6892ANJANA ANILKUMAR
 
Industrial Robotics Chap 01 Fundamentals
Industrial  Robotics  Chap 01  FundamentalsIndustrial  Robotics  Chap 01  Fundamentals
Industrial Robotics Chap 01 FundamentalsKevin Carvalho
 
HAND GESTURE CONTROLLED WHEEL CHAIR
HAND GESTURE CONTROLLED WHEEL CHAIRHAND GESTURE CONTROLLED WHEEL CHAIR
HAND GESTURE CONTROLLED WHEEL CHAIRNoufal Nechiyan
 
Enhanced robotic arm Abstract
Enhanced robotic arm AbstractEnhanced robotic arm Abstract
Enhanced robotic arm AbstractAshok Fair
 
Robotic Arm 5 degree of freedom (5 DOF)
Robotic Arm 5 degree of freedom (5 DOF)Robotic Arm 5 degree of freedom (5 DOF)
Robotic Arm 5 degree of freedom (5 DOF)Abdul Rehman Memon
 
Accelerometer controlled robot
Accelerometer controlled robotAccelerometer controlled robot
Accelerometer controlled robotMohit Keshav
 
wireless pick and place robotic arm
wireless pick and place robotic armwireless pick and place robotic arm
wireless pick and place robotic armAyush Verma
 
Jim Stertz: Automation and Robotic Arm: Maximizing Throughput and Capacity
Jim Stertz: Automation and Robotic Arm: Maximizing Throughput and CapacityJim Stertz: Automation and Robotic Arm: Maximizing Throughput and Capacity
Jim Stertz: Automation and Robotic Arm: Maximizing Throughput and Capacity360mnbsu
 

What's hot (20)

Wireless gesture controlled robot
Wireless gesture controlled robotWireless gesture controlled robot
Wireless gesture controlled robot
 
Real-time Obstacle Avoidance Algorithm for Mobile Robots
Real-time Obstacle Avoidance  Algorithm for Mobile RobotsReal-time Obstacle Avoidance  Algorithm for Mobile Robots
Real-time Obstacle Avoidance Algorithm for Mobile Robots
 
Obstacle avoiding robot
Obstacle avoiding robotObstacle avoiding robot
Obstacle avoiding robot
 
Wireless controlled robotic arm
Wireless controlled robotic armWireless controlled robotic arm
Wireless controlled robotic arm
 
Gesture Controlled Car_Project report
Gesture Controlled Car_Project reportGesture Controlled Car_Project report
Gesture Controlled Car_Project report
 
Gesture control car
Gesture control carGesture control car
Gesture control car
 
Mainprojpresentation 150617092611-lva1-app6892
Mainprojpresentation 150617092611-lva1-app6892Mainprojpresentation 150617092611-lva1-app6892
Mainprojpresentation 150617092611-lva1-app6892
 
Robochair
RobochairRobochair
Robochair
 
Industrial Robotics Chap 01 Fundamentals
Industrial  Robotics  Chap 01  FundamentalsIndustrial  Robotics  Chap 01  Fundamentals
Industrial Robotics Chap 01 Fundamentals
 
HAND GESTURE CONTROLLED WHEEL CHAIR
HAND GESTURE CONTROLLED WHEEL CHAIRHAND GESTURE CONTROLLED WHEEL CHAIR
HAND GESTURE CONTROLLED WHEEL CHAIR
 
Enhanced robotic arm Abstract
Enhanced robotic arm AbstractEnhanced robotic arm Abstract
Enhanced robotic arm Abstract
 
Robotic Arm 5 degree of freedom (5 DOF)
Robotic Arm 5 degree of freedom (5 DOF)Robotic Arm 5 degree of freedom (5 DOF)
Robotic Arm 5 degree of freedom (5 DOF)
 
Gesture Control Car
Gesture Control CarGesture Control Car
Gesture Control Car
 
ctdt report
ctdt reportctdt report
ctdt report
 
Accelerometer controlled robot
Accelerometer controlled robotAccelerometer controlled robot
Accelerometer controlled robot
 
wireless pick and place robotic arm
wireless pick and place robotic armwireless pick and place robotic arm
wireless pick and place robotic arm
 
Jim Stertz: Automation and Robotic Arm: Maximizing Throughput and Capacity
Jim Stertz: Automation and Robotic Arm: Maximizing Throughput and CapacityJim Stertz: Automation and Robotic Arm: Maximizing Throughput and Capacity
Jim Stertz: Automation and Robotic Arm: Maximizing Throughput and Capacity
 
Zeroth review.ppt
Zeroth review.pptZeroth review.ppt
Zeroth review.ppt
 
ROBOTIC - Introduction to Robotics
ROBOTIC - Introduction to RoboticsROBOTIC - Introduction to Robotics
ROBOTIC - Introduction to Robotics
 
G017534144
G017534144G017534144
G017534144
 

Viewers also liked

Character Profile: Christian Barker
Character Profile: Christian BarkerCharacter Profile: Christian Barker
Character Profile: Christian BarkerCallumKleber
 
Daily annoucements book clousure uptodated- 15.12.2015
Daily annoucements book clousure uptodated- 15.12.2015Daily annoucements book clousure uptodated- 15.12.2015
Daily annoucements book clousure uptodated- 15.12.2015RAFI SECURITIES (PVT.)LTD.
 
Quick Look At Op Manager
Quick Look At Op ManagerQuick Look At Op Manager
Quick Look At Op Managersiddel
 
FAQ: Hydro Ottawa plans duct and manhole work in Stittsville in 2017
FAQ: Hydro Ottawa plans duct and manhole work in Stittsville in 2017FAQ: Hydro Ottawa plans duct and manhole work in Stittsville in 2017
FAQ: Hydro Ottawa plans duct and manhole work in Stittsville in 2017StittsvilleCentral.ca
 
manage engines "Opmanager" Network monitoring tool
 manage engines "Opmanager" Network monitoring tool  manage engines "Opmanager" Network monitoring tool
manage engines "Opmanager" Network monitoring tool ER Swapnil Raut
 
195 Huntmar Drive - Fotenn planning rationale demonstration report
195 Huntmar Drive - Fotenn planning rationale demonstration report195 Huntmar Drive - Fotenn planning rationale demonstration report
195 Huntmar Drive - Fotenn planning rationale demonstration reportStittsvilleCentral.ca
 
Reimagine Business Models_Final_Oct_07_2016
Reimagine Business Models_Final_Oct_07_2016 Reimagine Business Models_Final_Oct_07_2016
Reimagine Business Models_Final_Oct_07_2016 Bertille Laudoux
 
Statement of claim Ottawa v MP Lundy et al Goulbourn Rec Complex
Statement of claim Ottawa v MP Lundy et al Goulbourn Rec ComplexStatement of claim Ottawa v MP Lundy et al Goulbourn Rec Complex
Statement of claim Ottawa v MP Lundy et al Goulbourn Rec ComplexStittsvilleCentral.ca
 
ONLINE_SAP_S4HANA_Roadmap_A4_FR
ONLINE_SAP_S4HANA_Roadmap_A4_FRONLINE_SAP_S4HANA_Roadmap_A4_FR
ONLINE_SAP_S4HANA_Roadmap_A4_FRBertille Laudoux
 

Viewers also liked (18)

Character Profile: Christian Barker
Character Profile: Christian BarkerCharacter Profile: Christian Barker
Character Profile: Christian Barker
 
Kdl
KdlKdl
Kdl
 
Història_mates
Història_matesHistòria_mates
Història_mates
 
lanka Praneeth CV
lanka Praneeth CVlanka Praneeth CV
lanka Praneeth CV
 
Trailers Answer Sheet
Trailers Answer SheetTrailers Answer Sheet
Trailers Answer Sheet
 
CAF World Giving Index 2015
CAF World Giving Index 2015CAF World Giving Index 2015
CAF World Giving Index 2015
 
Power point 2007
Power point 2007Power point 2007
Power point 2007
 
Los angeles tummy tucks
Los angeles tummy tucksLos angeles tummy tucks
Los angeles tummy tucks
 
Daily annoucements book clousure uptodated- 15.12.2015
Daily annoucements book clousure uptodated- 15.12.2015Daily annoucements book clousure uptodated- 15.12.2015
Daily annoucements book clousure uptodated- 15.12.2015
 
Quick Look At Op Manager
Quick Look At Op ManagerQuick Look At Op Manager
Quick Look At Op Manager
 
Arnaud
ArnaudArnaud
Arnaud
 
Exercicio 11 (2)
Exercicio 11 (2)Exercicio 11 (2)
Exercicio 11 (2)
 
FAQ: Hydro Ottawa plans duct and manhole work in Stittsville in 2017
FAQ: Hydro Ottawa plans duct and manhole work in Stittsville in 2017FAQ: Hydro Ottawa plans duct and manhole work in Stittsville in 2017
FAQ: Hydro Ottawa plans duct and manhole work in Stittsville in 2017
 
manage engines "Opmanager" Network monitoring tool
 manage engines "Opmanager" Network monitoring tool  manage engines "Opmanager" Network monitoring tool
manage engines "Opmanager" Network monitoring tool
 
195 Huntmar Drive - Fotenn planning rationale demonstration report
195 Huntmar Drive - Fotenn planning rationale demonstration report195 Huntmar Drive - Fotenn planning rationale demonstration report
195 Huntmar Drive - Fotenn planning rationale demonstration report
 
Reimagine Business Models_Final_Oct_07_2016
Reimagine Business Models_Final_Oct_07_2016 Reimagine Business Models_Final_Oct_07_2016
Reimagine Business Models_Final_Oct_07_2016
 
Statement of claim Ottawa v MP Lundy et al Goulbourn Rec Complex
Statement of claim Ottawa v MP Lundy et al Goulbourn Rec ComplexStatement of claim Ottawa v MP Lundy et al Goulbourn Rec Complex
Statement of claim Ottawa v MP Lundy et al Goulbourn Rec Complex
 
ONLINE_SAP_S4HANA_Roadmap_A4_FR
ONLINE_SAP_S4HANA_Roadmap_A4_FRONLINE_SAP_S4HANA_Roadmap_A4_FR
ONLINE_SAP_S4HANA_Roadmap_A4_FR
 

Similar to Resume

PC-based mobile robot navigation sytem
PC-based mobile robot navigation sytemPC-based mobile robot navigation sytem
PC-based mobile robot navigation sytemANKIT SURATI
 
A SMART VOICE CONTROLLED PICK AND PLACE ROBOT.pdf
A SMART VOICE CONTROLLED PICK AND PLACE ROBOT.pdfA SMART VOICE CONTROLLED PICK AND PLACE ROBOT.pdf
A SMART VOICE CONTROLLED PICK AND PLACE ROBOT.pdfAakash Sheelvant
 
A SMART VOICE CONTROLLED PICK AND PLACE ROBOT
A SMART VOICE CONTROLLED PICK AND PLACE ROBOTA SMART VOICE CONTROLLED PICK AND PLACE ROBOT
A SMART VOICE CONTROLLED PICK AND PLACE ROBOTIRJET Journal
 
DEVELOPMENT OF GESTURE CONTROLLED HEXAPOD USING WIRELESS TECHNOLOGY
DEVELOPMENT OF GESTURE CONTROLLED HEXAPOD USING WIRELESS TECHNOLOGYDEVELOPMENT OF GESTURE CONTROLLED HEXAPOD USING WIRELESS TECHNOLOGY
DEVELOPMENT OF GESTURE CONTROLLED HEXAPOD USING WIRELESS TECHNOLOGYIRJET Journal
 
ROBOTIC ARM WITH VOICE CONTROLLED AND IMAGE PROCESSING (1)
ROBOTIC ARM WITH VOICE CONTROLLED AND IMAGE PROCESSING (1)ROBOTIC ARM WITH VOICE CONTROLLED AND IMAGE PROCESSING (1)
ROBOTIC ARM WITH VOICE CONTROLLED AND IMAGE PROCESSING (1)Jayan Kant Duggal
 
MARK ROBOTIC ARM.ppt
MARK ROBOTIC ARM.pptMARK ROBOTIC ARM.ppt
MARK ROBOTIC ARM.ppttffttfyyf
 
IRJET- Amphibian Spy Robot for Continuous Monitoring
IRJET- Amphibian Spy Robot for Continuous MonitoringIRJET- Amphibian Spy Robot for Continuous Monitoring
IRJET- Amphibian Spy Robot for Continuous MonitoringIRJET Journal
 
IRJET- Amphibian Spy Robot for Continuous Monitoring
IRJET-  	  Amphibian Spy Robot for Continuous MonitoringIRJET-  	  Amphibian Spy Robot for Continuous Monitoring
IRJET- Amphibian Spy Robot for Continuous MonitoringIRJET Journal
 
Gesture controlled car.pdf
Gesture controlled car.pdfGesture controlled car.pdf
Gesture controlled car.pdfVikramBarapatre2
 
Design and Implementation of a Self-Balancing Two-Wheeled Robot Driven by a F...
Design and Implementation of a Self-Balancing Two-Wheeled Robot Driven by a F...Design and Implementation of a Self-Balancing Two-Wheeled Robot Driven by a F...
Design and Implementation of a Self-Balancing Two-Wheeled Robot Driven by a F...IRJET Journal
 
MARK ROBOTIC ARM.ppt
MARK ROBOTIC ARM.pptMARK ROBOTIC ARM.ppt
MARK ROBOTIC ARM.pptAfstddrrdv
 
Two wheeled self balancing robot for autonomous navigation
Two wheeled self balancing robot for autonomous navigationTwo wheeled self balancing robot for autonomous navigation
Two wheeled self balancing robot for autonomous navigationIAEME Publication
 
A Proportional-Integral-Derivative Control Scheme of Mobile Robotic platforms...
A Proportional-Integral-Derivative Control Scheme of Mobile Robotic platforms...A Proportional-Integral-Derivative Control Scheme of Mobile Robotic platforms...
A Proportional-Integral-Derivative Control Scheme of Mobile Robotic platforms...IOSR Journals
 
Automation biped robot @1000KV Technologies 9030844877
Automation biped robot @1000KV Technologies 9030844877Automation biped robot @1000KV Technologies 9030844877
Automation biped robot @1000KV Technologies 90308448771000kv technologies
 
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
 
Wireless bomb disposal robot ppt
Wireless bomb disposal robot pptWireless bomb disposal robot ppt
Wireless bomb disposal robot pptAbhishek Gupta
 
Ieee embedded 2015_16
Ieee embedded  2015_16Ieee embedded  2015_16
Ieee embedded 2015_16fe online
 
Two wheel self balancing robot
 Two wheel self balancing robot Two wheel self balancing robot
Two wheel self balancing robotadeela aslam
 

Similar to Resume (20)

PC-based mobile robot navigation sytem
PC-based mobile robot navigation sytemPC-based mobile robot navigation sytem
PC-based mobile robot navigation sytem
 
A SMART VOICE CONTROLLED PICK AND PLACE ROBOT.pdf
A SMART VOICE CONTROLLED PICK AND PLACE ROBOT.pdfA SMART VOICE CONTROLLED PICK AND PLACE ROBOT.pdf
A SMART VOICE CONTROLLED PICK AND PLACE ROBOT.pdf
 
A SMART VOICE CONTROLLED PICK AND PLACE ROBOT
A SMART VOICE CONTROLLED PICK AND PLACE ROBOTA SMART VOICE CONTROLLED PICK AND PLACE ROBOT
A SMART VOICE CONTROLLED PICK AND PLACE ROBOT
 
pick and place ppt.ppt
pick and place ppt.pptpick and place ppt.ppt
pick and place ppt.ppt
 
DEVELOPMENT OF GESTURE CONTROLLED HEXAPOD USING WIRELESS TECHNOLOGY
DEVELOPMENT OF GESTURE CONTROLLED HEXAPOD USING WIRELESS TECHNOLOGYDEVELOPMENT OF GESTURE CONTROLLED HEXAPOD USING WIRELESS TECHNOLOGY
DEVELOPMENT OF GESTURE CONTROLLED HEXAPOD USING WIRELESS TECHNOLOGY
 
ROBOTIC ARM WITH VOICE CONTROLLED AND IMAGE PROCESSING (1)
ROBOTIC ARM WITH VOICE CONTROLLED AND IMAGE PROCESSING (1)ROBOTIC ARM WITH VOICE CONTROLLED AND IMAGE PROCESSING (1)
ROBOTIC ARM WITH VOICE CONTROLLED AND IMAGE PROCESSING (1)
 
MARK ROBOTIC ARM.ppt
MARK ROBOTIC ARM.pptMARK ROBOTIC ARM.ppt
MARK ROBOTIC ARM.ppt
 
IRJET- Amphibian Spy Robot for Continuous Monitoring
IRJET- Amphibian Spy Robot for Continuous MonitoringIRJET- Amphibian Spy Robot for Continuous Monitoring
IRJET- Amphibian Spy Robot for Continuous Monitoring
 
IRJET- Amphibian Spy Robot for Continuous Monitoring
IRJET-  	  Amphibian Spy Robot for Continuous MonitoringIRJET-  	  Amphibian Spy Robot for Continuous Monitoring
IRJET- Amphibian Spy Robot for Continuous Monitoring
 
Gesture controlled car.pdf
Gesture controlled car.pdfGesture controlled car.pdf
Gesture controlled car.pdf
 
Design and Implementation of a Self-Balancing Two-Wheeled Robot Driven by a F...
Design and Implementation of a Self-Balancing Two-Wheeled Robot Driven by a F...Design and Implementation of a Self-Balancing Two-Wheeled Robot Driven by a F...
Design and Implementation of a Self-Balancing Two-Wheeled Robot Driven by a F...
 
MARK ROBOTIC ARM.ppt
MARK ROBOTIC ARM.pptMARK ROBOTIC ARM.ppt
MARK ROBOTIC ARM.ppt
 
Two wheeled self balancing robot for autonomous navigation
Two wheeled self balancing robot for autonomous navigationTwo wheeled self balancing robot for autonomous navigation
Two wheeled self balancing robot for autonomous navigation
 
A Proportional-Integral-Derivative Control Scheme of Mobile Robotic platforms...
A Proportional-Integral-Derivative Control Scheme of Mobile Robotic platforms...A Proportional-Integral-Derivative Control Scheme of Mobile Robotic platforms...
A Proportional-Integral-Derivative Control Scheme of Mobile Robotic platforms...
 
Automation biped robot @1000KV Technologies 9030844877
Automation biped robot @1000KV Technologies 9030844877Automation biped robot @1000KV Technologies 9030844877
Automation biped robot @1000KV Technologies 9030844877
 
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...
 
Quadcopter
QuadcopterQuadcopter
Quadcopter
 
Wireless bomb disposal robot ppt
Wireless bomb disposal robot pptWireless bomb disposal robot ppt
Wireless bomb disposal robot ppt
 
Ieee embedded 2015_16
Ieee embedded  2015_16Ieee embedded  2015_16
Ieee embedded 2015_16
 
Two wheel self balancing robot
 Two wheel self balancing robot Two wheel self balancing robot
Two wheel self balancing robot
 

Resume

  • 1. Resume NAME ANDIKA PRAMANTA YUDHA (ANDY) EMAIL ANDIKA.PRAMANTA.YUDHA@GMAIL.COM SKYPE DIKAYUDHA8 DATE OF BIRTH OCTOBER 29TH, 1990
  • 2. PERSONAL EXPERIENCENTUST Master graduated with 3.96 GPA. Interested in Humanoid Robot, Unmanned Aerial Vehicle, Delta Robot Manipulator, all kind of Control System, and Embedded System. C# Programming Language C++ Programming Language JAVA Programming Language MATLAB Control Theory Robotics (Humanoid, Delta Robot Manipulator, UAV Quad rotor) Embedded System (AVR and ARM) CORE COMPETENCIES 2011 2012 2013 2014 2015 Voltage and Current Measuring Device Instrument Indonesian Payload Rocket Competition Project Approval Website for PLN UAV Quad rotor Research UAV Quad rotor Research Delta Robot Manipulator Project Humanoid Teen Size Project Humanoid Teen Size Project Exoskeleton Project
  • 3. AWARDS 1 32ST PLACE ND PLACE RD PLACE 2015 Technical Challenge in Robocup, international Humanoid Robot Soccer Competition in Heifei, China 2011 International Robotic Olympiad, Creative Robot category (using Quad rotor and car robot) by IROC (International Robotic Olympiad Committee) in Jakarta, Indonesia 2015 Soccer Game Competition in Robocup, international Humanoid Robot Soccer Competition in Heifei, China 2015 FIRA International Intelligent Humanoid Robot Competition in Kaohsiung, Taiwan ST PLACE of Freshman Category 1 2014 Delta Robot Competition in National Taiwan University, Taipei, Taiwan
  • 4. PORTFOLIO DELTA ROBOT This delta robot is made by NTUST Medical Robot Laboratory Students for Delta Robot Competition held in National Taiwan University in 2014. This robot is actuated with 3 HIWIN AC motors to move the end effector in 3D space, and controlled using ARM STM32 Microcontroller. The competition goal were to do the stamping as many as the robot can, and also pick an object, and move it along the trajectory which is decided by the competition rule. This robot won the 1st place of freshman category. The honor is posted in front of Electrical and Electronic Engineering building in NTUST. TEEN-SIZE HUMANOID The goal for the project was to create the teen size humanoid robot which be able to walk, fall down and stand up. This robot also can play soccer. To achieve this goal, vision detection is utilized to recognize the ball, and also make decision about where to move the detected ball. My part was to utilize the locomotion control so that robot can walk. We used LIPM concept for Hip trajectory and also maintain the robot’s CoG(center of gravity). AHRS sensor was used for robot walking stabilization, and also fall detection to perform stand up procedure. EXOSKELETON My part of this project will be the leg control using Regressor Free Adaptive Impedance control as the compliance control, so that the robot will be able to adapt based on patient leg movement, and also Disturbance observer to estimate external torque and amplify it for the passive power assisted exoskeleton.
  • 5. QUADROTOR BACHELOR THESIS, 2012 TOOLS MBED WEB-COMPILER ARDUINO IDE MATLAB METHOD DCM FOR IMU PID CONTROL Multithreading SENSORS ACCELEROMETER GYROSCOPE MAGNETOMETER DEVICES ARM CORTEX M3 ARDUINO 2.4 GHz Wireless Remote xbee HOW IT WORKS UART 1 PWM OUT(1-4) PWMIN UART2 ACTUATORS 4X Brushless Motor DC + ESC USER INPUT DEVICE 4 CHANNEL REMOTE CONTROL ACCELEROMETER GYROSCOPE MAGNETOMETER XBEE 1. Remote Control Input will be the desired inputs of Roll Pitch and Yaw 2. PID Control will be utilized to control the attitude by calculate the error from desired attitude from remote control and ACCELEROMETER + GYROSCOPE + MAGNETOMETER 3. ACCELEROMETER + GYROSCOPE + MAGNETOMETER outputs will be calculated using Direction Cosine Matrix to reject noise and drift from those sensors and forming 9 x 9 orientation matrix so the roll pitch and yaw output could be obtained. 4. PID output will be the input for brushless DC motors 5. Attitude data will be sent through xbee for analyzing
  • 6. Exoskeleton MASTER THESIS AND TAIWAN NATIONAL SCIENCE COUNCIL PROJECT, 2015 TOOLS Visual Studio 2015 SMART Motor Interface MATLAB METHOD Adaptive control Disturbance observer Multithreading SENSORS POSITION ENCODER VELOCITY ENCODER DEVICES STM32F429 (ARM CORTEX M3) SMART MOTORS 4X HOW IT WORKS ACTIVE-ASSISTED EXOSKELETON 1. Exoskeleton will move based on the certain trajectory, and the patient leg will follow the movement. 2. The motor position and velocity will be sent through serial communication from the motor to microcontroller and control it using ADAPTIVE CONTROL to follow the trajectory. 3. This control requires NO ACCELERATION FEEDBACK and SYSTEM DYNAMIC PASSIVE-ASSISTED EXOSKELETON 1. Position and Velocity from the motor will be red as the input to measure external torque using DISTURBANCE OBSERVER 2. The system will amplify the torque estimated to assist the patient movement 3. Gravity compensation is needed to get rid of gravity effect ACTUATORS 4X SMART MOTOR With Position and Velocity Encoders Inside UART1 UART2 USB USB TO TTL FTDI PC With Windows Operating System
  • 7. Exoskeleton MASTER THESIS AND TAIWAN NATIONAL SCIENCE COUNCIL PROJECT, 2015 TOOLS Visual Studio 2015 SMART Motor Interface MATLAB METHOD Adaptive control Disturbance observer Multithreading SENSORS POSITION ENCODER VELOCITY ENCODER DEVICES STM32F429 (ARM CORTEX M3) SMART MOTORS 4X Control System Diagram Passive Assisted Exoskeleton Active Assisted Exoskeleton Gravity compensation Exoskeleton Actuators Disturbance Observer Human K 𝑞, 𝑞 𝑔(𝑞) 𝜏ℎ 𝜏 𝑑 + − + Motion Planner Adaptive Control Exoskeleton Actuators Disturbance Observer 𝑞 𝑑 𝑞, 𝑞 𝑞 𝜏 𝑑 𝜏 𝜏+ − + + +
  • 8. Delta Robot DELTA ROBOT EVOLUTION, 2014 TOOLS Visual Studio 2015 SMART Motor Interface MATLAB METHOD Adaptive control Disturbance observer Multithreading SENSORS POSITION ENCODER VELOCITY ENCODER DEVICES STM32F429 (ARM CORTEX M3) SMART MOTORS 4X HOW IT WORKS 1. Trajectory of the end effector is generated based on the competition rule 2. Air gripper is used to grab objects and move it to certain position 3. Delta robot inverse kinematic is used to get the desired rotational position for 3 main actuators 4. We used default PID position control from motor driver 5. Communication from microcontroller to AC Servo motor driver is based on pulse counter for desired rotational position and pulse frequency for the desired speed. ACTUATORS 3X HIWIN AC SERVO MOTOR DigitalI/OPINs UART1 USB USB TO TTL FTDI PC With Windows Operating System
  • 9. TEEN-SIZE HUMANOID TAIWAN NATIONAL SCIENCE COUNCIL PROJECT, 2015 TOOLS Arduino IDE MATLAB METHOD LIPM PD Control SENSORS Accelerometer Gyroscope Magnetometer DEVICES Arduino Mega (ATMEGA 2560) Dynamixel NX-106 Switch IC HOW IT WORKS 1. LIPM is used to create the hip trajectory when the robot perform omni-directional movement 2. Besides LIPM we also create foot trajectory. Together with LIPM trajectory output, we calculate the robot inverse kinematic to get motor rotational position of Robot’s leg. 3. MX-106 dynamixel motor has its own PID control for motor rotational position control. 4. Gyroscope is used to read and use PD control stabilize the robot walking. 5. Using DCM algorithm, we calculate the robot orientations and use them to detect whether the robot falls down or still walking and perform safety fall then stand up procedure if the robot falls. 6. Using DCM, we can know robot position relative to north direction, and we will use that orientation to define the goalpost in soccer competition. UART 2I2C USB USB IntelNUC Arduino Mega Acc+gryo+ magneto Actuators 13x
  • 10. TEEN-SIZE HUMANOID TAIWAN NATIONAL SCIENCE COUNCIL PROJECT, 2015 TOOLS Arduino IDE MATLAB METHOD LIPM PD Control SENSORS Accelerometer Gyroscope Magnetometer DEVICES Arduino Mega (ATMEGA 2560) Dynamixel NX-106 Switch IC LIPM LIPM Zc LIPM Gravity Init LIPM Gravity Final Foot Trajectory ∆𝜃 ∆𝑥 ∆𝑦 Inverse Kinematic Intel NUC Power Cutoff Delay Stand Up Procedure PD Control Servo Motor IMU Vision System 𝐹𝑜𝑜𝑡 𝑇𝑟𝑎𝑗𝑒𝑐𝑡𝑜𝑟𝑦 Parameters 𝐻𝑖𝑝 𝑇𝑟𝑎𝑗𝑒𝑐𝑡𝑜𝑟𝑦 𝐹𝑜𝑜𝑡 𝑇𝑟𝑎𝑗𝑒𝑐𝑡𝑜𝑟𝑦 + + LIPM Parameters SWITCH SWITCH Control System Overview
  • 11. THANK YOU FOR YOUR ATTENTION