Modeling and Controlling the Actuator Joint Angle Position on the Robot Arm Base Using Discrete PID Algorithm (original) (raw)

Position Control of a Manipulator Using PID Control Algorithm Based on ATmega8535 Microcontroller

This paper describes about implementation of Proportional Integral Derivative (PID) control algorithm for controlling position of robot manipulator. The robot has three degree of freedoms and therefore, three DC motors are used as the actuators. PID control algorithm was implemented on a microcontroller platform. The microcontroller used in this system is ATmega8535. For detecting the position of each link of the robot, incremental rotary encoder is used as the position sensor. Microcontroller read the position from the sensor and then by using PID control algorithm, the microcontroller control the speed and direction of DC motor in order to control the position of link of the robot. Experiment was done in variation of value of PID parameter. Experimental results show that the best response is obtained with Kp = 1, Ki = 0.01 to 0.04, and Kd = 0. This means that the best control algorithm for position control is PI controller.

DC Motor Angular Position Control using PID Controller with Friction Compensation

International Journal of Scientific and Research Publications (IJSRP), 2018

This paper finds to get the precision of angular position control for DC geared motor using PID controller. The Arduino microcontroller board is mainly used to control the 12V brushed Namiki DC motor. L298N dual H-bridge motor driver is applied to execute the pulse width modulation (PWM) signal and to drive the direction control. The implementation code is considered to generate the PWM output using PID (proportional, integral and derivative) tuning algorithms. According to the PID tuning method, errors are not only solved but also taken to its minimal value with very low amount of error oscillations. In this work, step input, sine input and potentiometer input are tested to analyze the system performance. The results were clearly seen, the controller output response curve is very well-matched to approach the desired position. But, it has a few errors when the orientation of changes angle because they are not fast to reach the desired position. Therefore, friction compensation according to the velocity effect is considered. After compensating the friction effect, the PID output results were very precise to get the desired angle. This stability performance using PID controller can be applied for robotic arm position control system and other industrial applications.

Control of DC Motor Using Proportional Integral Derivative (PID): Arduino Hardware Implementation

2020 2nd International Conference on Industrial Electrical and Electronics (ICIEE), 2020

The research proposes controlling DC motor angular speed using the Proportional Integral Derivative (PID) controller and hardware implementation using a microcontroller. The microcontroller device is Arduino Uno as data processing, the encoder sensor is to calculate the angular speed, and the motor driver is L298. Based on the hardware implementation, the proportional controller affects the rise time, overshoot, and steady-state error. The integral controller affects overshoot and undershoot. The derivative controller affects overshoot insignificantly. The best parameter PID is Kp=1, Ki=0.3, and Kd=0.1 with system response characteristic without overshoot and undershoot. Using various set point values, the controller can make the DC motor reach the reference signal. Thus, the PID controller can control, handle, and stabilize the DC motor system.

Comparative Study Of PD, PI And PID Controllers For Control Of A Single Joint System In Robots

The International Journal of Engineering and Science , 2018

I. INTRODUCTION Industrial design of Robots requires that their Joints are normally actuated by simple DC motors which results in the flexible rotation of the Joints. The principle of operation of the system requires that Change in magnetic field of a moving magnet induces an EMF to a coil which then causes rotation of the Armature and therefore producing a resultant torque which causes the arm attached to the motor to rotate[1],[5]. This kind of system is unstable at open loop, making it necessary for the application of a controller to guarantee set-point tracking and stabilization[8]. The three parameters to be compared in this work are the Proportional action, Derivative action and Integral action. The proportional action or gain will drive a system to set-point, the derivative action will help to reduce oscillation at steady state or damp overshoots at transient, and the integral action will deal with steady state errors[9]. [4] had done a similar work by comparing the action of P,PI and PID controllers for speed control of VSI-fed induction motor, and the results showed that each controller contributed its own unique performance to the closed loop system.[6] used PID control for speed control of a DC motor and got some satisfactory result on the steady state performance while [2],[3],[7] have applied PI control for DC motors and confirmed that Integral action really leads to steady state off set cancellation. The application of PD controllers has also been verified by [9] where it was discovered that the system is stabilized from steady state, however steady state errors can still be maintained all through. In reality such a system must always encounter fault and disturbances hence[3] proposed and simulated rotation of this motors encountering faults, [2] has also attempted to observe this faults and parameter states by designing a Kalman Filter for state observation and results obtained has been encouraging and consistent with stability. Other work done on DC motors have focused mostly on speed control hence [5][7][8] have all presented that PID controllers are very reliable and stabilizing when it comes to control of the DC motors as actuators. In this work we are concerned in the comparative performance of PD, PI and PID controllers as the act to control and stabilize a single joint system shown in Fig.1.

A PID Controlled Real Time Analysis of DCMotor

International Journal of Innovative Research in Computer and Communication Engineering, 2013

Conventional PID controllers are used to control the dc motor for various industrial processes from many years due to their simplicity in operation. PID controllers require mathematical models to control the plant for different process control applications. In this paper worked out, speed control analysis of DC motor using PID controller. Speed control of separately excited dc motor is done using armature voltage control method. PID controller basics are briefed and various tuning methods of PID controller are explained. Mathematical modelling of dc motor is done and is simulated in Simulink. The control system consisting of PID controlled dc motor is also simulated in Simulink. Response of dc motor is recorded as simulation result when step input is provided as reference signal. Thereby, performance analysis of dc motor with PID controller is performed by calculating various response parameters such as maximum overshoot, rise time, settling time, etc.

Arm Manipulator Position Control Based On Multi-Input Multi-Output PID Strategy

Journal of Automation, Mobile Robotics & Intelligent Systems, 2014

A robot manipulator is a multi-articulated mechanical system, in which each articulation is driven individually by an electric actuator. As the most used robot in industrial application, this system needs an efficient control strategy such as the classical PID control law by means of which each articulation is controlled independently. This kind of control presents a lot of inconvenient, such as error of each articulation isn't taken account into others. In this work we present a Multi Input Multi Output (MIMO) PID controller to ensure the articulation robot control strategy, the results obtained present satisfactory and shows clearly the efficiency of the present PID-MIMO controller.

Control of DC Motor Using Integral State Feedback and Comparison with PID: Simulation and Arduino Implementation

Journal of Robotics and Control (JRC), 2021

The Direct Current (DC) motor is widely applied in various implementations. The main problem in the DC motor is controlling the angular speed on the specific reference. This research then proposed an integral state feedback design for tracking control in DC motor, with Simulink Matlab simulation and the Arduino hardware implementation. The results will be compared with the implementation of the PID controller. The integral state feedback controller can handle the system to reach the setpoint with good performance in the simulations, even with changing different poles and setpoints. In the hardware implementation, the current sensor (INA219) and encoder sensor are used since all state variables need to be calculated. Based on the result, the controller can reach the setpoint stably with oscillation. Similar results are showed in simulations with different setpoints. Compared with the PID Controller, the integral state feedback controller has a better response with faster rise time and faster settling time.

DC Motor Rotary Speed Control with Arduino UNO Based PID Control

Control Systems and Optimization Letters

Along with the development of the times, DC motors are often used in industrial equipment or household appliances, but in DC motors they often experience a decrease due to the given load, it requires a controller. This research uses PID (Proportional Derivative) controller. In this study, the DC motor can be controlled despite the load using the trial and error method. This study uses Arduino UNO software for testing using parameters Kp=1.5, Ki=0.87, Kd=0.27. parameter y is the parameter value Kp, Ki, Kd obtained from the system response according to the software used. the value of rise time = 0.9925 Tested, Time = 2.7368, Overshoot = 1.3333 and Steady State Error = 0

Performance comparison between variants PID controllers and unity feedback control system for the response of the angular position of the DC motor

International Journal of Electrical and Computer Engineering (IJECE), 2021

This paper proposed a detailed study for the response of angular position of the rotor of a DC motor. It is a comparative analysis to the behavior of the DC motor when the motor is alone and when it is with controllers. Furthermore, a comparison between the responses of controllers themselves. A conventional PID controller which was tuned by using Ziegler and Nichols method was proposed in this paper. Also, Modification PID controllers were proposed in this paper. The modification PID controllers are PI-D controller and I-PD controller. Mathematical calculations were done to get the transfer functions for the DC motor and the controllers. Time domain specifications and figures were obtained for each case by using Matlab program. The obtained results were summarized in tables. This paper determined which the controller is the best one depending on the obtained figures and the time domain specifications.

PID Controller based DC Motor Speed Control

– Due to extensive use of motion control system in industry, there has been growing research on proportional-integral-derivative (PID) controllers. DC motors are widely used various areas of industrial applications. The aim of this paper is to implement efficient method for controlling speed of DC motor using a PID controller based. Proposed system is implemented using arduino microcontroller and PID controller. Motor speed is controlled through PID based revolutions per minute of the motor. This encoder data will be send through microcontroller to Personal Computer with PID controller implemented in MATLAB. Results shows that PID controllers used provide efficient controlling of DC motor.