International Publishing Platform
Serving Researchers Since 2012

Robotic Arm Design for Trajectory Tracking Application

DOI : https://doi.org/10.5281/zenodo.18327018
Download Full-Text PDF Cite this Publication

Text Only Version

 

Robotic Arm Design for Trajectory Tracking Application

Shrutarth Sanjay Aswale, Isha Ashok Akhade, Harshada Vinod Jathe, Aasavari Kiran Munde, Shaktikumar Ranjit Shiledar

Electronics and Telecommunication Engineering Department (Affiliated to Dr. Babasaheb Ambedkar Technological university Lonere)

Government College of Engineering Yavatmal Yavatmal, India

Abstract – A trajectory tracking robotic arm is an automated mechanical system designed to follow a predefined path with high accuracy, stability, and repeatability. The primary objective of this project is to develop a robotic arm capable of executing smooth and precise motion trajectories for applications such as material handling, sorting, pick-and-place operations, and industrial automation. The system integrates microcontrollers, servo motors, sensors, and control algorithms to achieve reli- able movement control. In this project, trajectory tracking is implemented using real-time feedback and control techniques such as PID control, which minimizes the error between the desired and actual position of the arm. The robotic arm is programmed to follow specific motion profiles while maintaining speed, orientation, and accuracy under varying load conditions. Sensors like IR arrays, color sensors, and encoders enhance its ability to detect objects and adjust its path dynamically. The developed system demonstrates efficient trajectory tracking performance with improved precision and reduced response time. This work highlights the importance of closed-loop control, sensor fusion, and lightweight mechanical design in achieving accurate robotic motion. Such robotic arms have significant potential in industrial automation, agriculture, healthcare, and service robotics, contributing to improved productivity and re- duced human effort.

Index Terms – component, formatting, style, styling, insert

  1. INTRODUCTION

    Automation started to develop as an important engineering field around the time of the Second World War, especially in Asian and northern industrial countries, where automated machines were required for large-scale production and indus- trial growth [1]. However, the basic idea of automation existed much earlier. Early research on steam engines showed how machines could convert energy into mechanical motion and perform work with limited human involvement [2].

    With the progress of electrical and electronics engineering, automation systems improved significantly. The development of silicon and semiconductor technologies made it possible to design electronic devices that could control mechanical systems accurately and efficiently [3]. These technologies enabled the integration of sensors, controllers, and actuators, leading to modern automated systems capable of performing complex tasks. As a result, automation became widely used in industries such as manufacturing, transportation, and process control [4].

    The concept of robotics has roots in ancient mytholog- ical and literary narratives, where mechanical beings were imagined as artificial human-like entities capable of acting autonomously, reflecting humanity s early vision of intelligent machines [5]. Modern robotics has transformed these ideas into practical engineering systems through advances in mecha- tronics, control theory, and artificial intelligence [8]. Trajectory tracking for robotic manipulators started to take shape in the 1970s and early 1980s, when research shifted from simple motion to precise control, dynamic modeling, and real-time implementation [14]. In contemporary engineering, robotics and automation are central to autonomous systems such as industrial manipulators, mobile robots, and autonomous vehi- cles, where accurate trajectory tracking is essential for safety, efficiency, and task reliability [12]. Consequently, research focuses on robust control design and real-time execution to achieve high-precision trajectory tracking performance.

    A robotic manipulator designed for trajectory tracking func- tions on the foundational concepts of kinematics and dynamics [15]. Kinematics specifies how joint movements correspond to the position and orientation of the end-effector, while dynamics explains the influence of forces, torques, and motion characteristics on the systems behavior. Within this frame- work, inverse kinematics is essential because it determines the joint configurations required to follow each point on the intended path [8]. Performing inverse kinematics in real time ensures that all joints move in a coordinated manner, enabling smooth and continuous trajectory execution.

    To obtain high positional accuracy, trajectory-tracking sys- tems typically use a closed-loop control approach. Sensors such as rotary encoders, infrared modules, color sensors, and inertial measurement units (IMUs) continuously mon- itor joint states and environmental conditions. Their feed- back is compared against the reference trajectory, and the controller often a PID controller or a more sophisticated algorithm generates corrective inputs to minimize deviations [16]. This recursive cycle of sensing, comparison, and adjust- ment plays a key role in maintaining precision, robustness, and overall system stability.

    The actuation mechanism generally consists of servo mo- tors, including commonly used models such as MG996R and

    SG90, which translate control signals into joint motion [17]. Additional hardwaresuch as motor drivers, microcontrollers like the ESP32, and power-management circuitssupports reliable operation. Furthermore, trajectory-generation methods are employed to create smooth velocity and acceleration curves, which protect mechanical components from sudden jerks and help maintain consistent motion accuracy.

  2. ROBOT SYSTEM

    A robotic system operates as an integrated mechatronic platform that combines mechanical structure, electrical actu- ation, sensing, and intelligent software control. The motion of the robotic arm is driven by electrical motors, while its position and orientation are continuously monitored through embedded sensors. These sensor measurements are processed by the control software to generate appropriate commands that regulate motor actions, ensuring accurate and stable movement. As a mechatronic system, the robot coordinates mechanical components, electronic interfaces, and real-time computational algorithms to execute tasks along a predefined trajectory with high precision. The complete system consists of multiple sensors for state feedback, actuators for motion generation, and a control unit that governs trajectory tracking, error correction, and overall system performance. Together, these elements enable the robot to perform the required tasks efficiently, reliably, and with consistent accuracy.

    1. Mechanical Subsystem

      This includes all physical parts of the robotic arm.

      • Components: Links (rigid bodies), Joints (revolute or prismatic), Actuators (Servo/DC/Stepper motors), End- effector (gripper/tool).
      • Role: Provides physical movement to follow the desired trajectory.
    2. Sensing Subsystem

      Sensors measure the real-time state of the robot.

      • Typical sensors: Encoders, Gyroscope/IMU, IR/Ultrasonic/Proximity sensors, Force/Torque sensors, Vision modules.
      • Role: Provides feedback to ensure the arm stays on the desired trajectory.
    3. Control Subsystem

      This is the brain of trajectory trackng.

      • Hardware: Microcontroller (ESP32, Arduino, STM32, Raspberry Pi).
      • Algorithms: Computed Torque Control, Adaptive Con- trol, Model Predictive Control, Fuzzy/Neural controllers.
      • Role: Compares the desired trajectory with the actual motion and corrects any error.
    4. Trajectory Generation Subsystem

      This subsystem plans how the robot should move.

      • Functions: Generates the path (straight line, curve, arc), decides velocity/acceleration profiles, converts path to joint angles using Forward and Inverse Kinematics.
      • Output: A set of reference trajectories for each joint.
    5. Power Subsystem

      Supplies energy to all components.

      • Components: Batteries (Li-ion), Power converters (XL4015, LM2596), Voltage regulators, Motor drivers (L298N).
      • Role: Ensures stable power delivery to motors, con- trollers, and sensors.
    6. Communication Subsystem

      Handles data flow between modules (I2C, SPI, UART) and external communication (Wi-Fi/Bluetooth).

    7. Software & Algorithm Subsystem

    Contains the logic for trajectory tracking, including kine- matic models, path planning modules, motion control algo- rithms, and RTOS.

  3. DYNAMIC MODEL FOR ROBOTIC MANIPULATOR
    1. Dynamic Modeling and Trajectory Tracking Control of a Robotic Arm

      For an n-degree-of-freedom (DOF) robotic manipulator, the joint-space dynamic model incorporating inertial, Coriolis and centripetal, gravitational, and frictional effects can be expressed as

      M (q)q¨ + C(q, q)q + G(q) + F (q) = (1)

      where q Rn denotes the vector of joint positions, q and

      represent the joint velocities and accelerations, respectively. The matrix M (q) Rn×n is the positive-definite inertia matrix, C(q, q) Rn×n represents the Coriolis and centripetal effects, G(q) Rn is the gravity vector, F (q) denotes the joint friction, and Rn is the vector of applied joint torques.

      1. Trajectory Tracking Formulation: For trajectory track- ing, a desired joint-space trajectory is defined as qd(t) with corresponding velocity qd(t) and acceleration q¨d(t). The track- ing error and its derivative are defined as

        e = qd q, e = qd q. (2)

        A commonly used computed-torque (inverse dynamics) control law is given by

        = M (q) q¨d + Kve + Kpe + C(q, q)q + G(q), (3)

        where Kp Rn×n and Kv Rn×n are symmetric positive- definite gain matrices.

        Substituting (3) into (1), and neglecting friction for clarity, the closed-loop tracking error dynamics reduce to

        e¨ + Kve + Kpe = 0, (4)

        which represents a stable second-order linear system, ensuring

        asymptotic convergence of the tracking error.

        Fig. 1. Robotic Arm

      2. Two-Link Planar Robotic Arm Model: To illustrate the formulation, consider a two-link planar robotic manipulator with joint variables q1 and q2:
        1. Compute kinetic + potential energy
        2. Apply Lagranges equations to get M (q), C(q, q), G(q)
        3. Use the above trajectory tracking control law.
    2. Project Implementation

      In the proposed work,the trajectory tracking robotic arm is working with following sequence for desired trajectory tracking application as

      1. Choose a trajectory qd(t) (e.g., polynomial, spline, or via points).
      2. Implement or approximate the dynamic model M, C, G

        (simplified if needed).

      3. Apply a control law:
        • simple: PD control in joint space
        • better: computed-torque (inverse dynamics) control as above
      4. Simulate in MATLAB/Simulink or Python, then test on hardware.
    3. Overall System Flow

      q = q1 q2

      , = 1 2

      . (5)

      1. Path Planned 2) Trajectory Generated 3) Controller computes signals 4) Motors execute movement

    The dynamic equations of motion are expressed as

    M (q)q¨ + C(q, q)q + G(q) = , (6)

    where the inertia matrix M (q), Coriolis/centripetal matrix C(q, q), and gravity vector G(q) are derived using standard Lagrangian or NewtonEuler formulations based on the physi- cal parameters of the manipulator, such as link masses, lengths, and moments of inertia.

    The inertia matrix is given by

    M11 M12

    5) Sensors give feedback 6) Controller corrects errors

    7) Smooth trajectory tracking achieved.

  4. SYSTEM ARCHITECTURE AND ANALYSIS

    The system architecture of the Trajectory Tracking Robotic Arm is designed to integrate line following, object detection, color recognition, and robotic arm manipulation under a single control unit (ESP32 V4). The architecture is divided into three main subsystems:

    1. Locomotion Subsystem

      with

      M (q) =

      M12 M22 , (7)

      This subsystem is responsible for the movement of the robot.

      It consists of the ESP32 controller, L298N motor driver, and DC motors. The 6-channel IR array sensor provides continuous

      M12 = I2 + m2(r2 + l1r2 cos q2), (9)

      M11 = I1 + I2 + m1r2 + m2(l2 + r2 + 2l1r2 cos q2), (8)

      M22 = I2 + m2r2. (10)

      The Coriolis and centripetal matrix is expressed as

      feedback for line tracking and ensures the robot follows the predefined path accurately.

    2. Sensing Subsystem

      This subsystem includes sensors that interact with the environment. The front IR sensor detects the presence of

      where

      C(q, q) = 2hq2 hq2 , (11)

      hq1 0

      h = m2l1r2 sin q2. (12)

      an object ahead, while the TCS3200 colour sensor identifies the colour of the object (blue or green). These sensors provide input signals to the ESP32 for decision-making.

    3. Manipulation Subsystem

      The gravity vector is given by

      G(q) = (m1r1 + m2l1)g cos q1 + m2r2g cos(q1 + q2) .

      m2r2g cos(q1 + q2)

      (13)

      This nonlinear and coupled dynamic model forms the basis for the trajectory tracking control design discussed in this work. . In your report or thesis you usually:

      1. Define DH parameters

        The robotic arm, controlled by four servo motors, performs the pick-and-place operation. Based on the colour identified by the TCS3200 sensor, the ESP32 directs the arm to pick the object and place it either to the right (blue) or left (green) side. The ESP32 functions as the central controller, collecting sensor data, processing it in real time, and generating ap- propriate output commands. The architecture uses a closed- loop control mechanism for line tracking and an event-driven

        mechanism for object detection. When the robot encounters an object, the locomotion subsystem halts, and control is shifted to the manipulation subsystem.

    4. Sensors and Path Tracking System

      A Path Tracking System enables a robotic arm to follow a predefined trajectory accurately.

      1. Position Sensors:
        • Potentiometers: Measures rotational angles; used in low- cost arms.
        • Encoders: Optical or Magnetic. Highly accurate and used in industrial robots for exact joint anges.
        • Hall Effect Sensors: Detect magnetic fields for speed or position.
      2. Motion and Orientation Sensors:
        • IMU: Tracks orientation, tilt, and motion.
        • Gyroscope: Measures rotational speed to stabilize arms.
      3. Proximity and Object Detection Sensors:
        • IR Sensors: Line tracking and obstacle detection.
        • Ultrasonic Sensors: Collision avoidance via sound waves.
        • TCS3200 Color Sensor: Detects colors for sorting.
        • Vision Sensor: Image processing for path detection.
    5. Path Tracking System Components
        • Trajectory Planning: Defines the path (Bezier, spline curves).
        • Controllers: PID (ProportionalIntegralDerivative) cor- rects errors; Feedforward predicts movement; Hybrid combines both.
        • Motors: Servos (angle control), Steppers (fixed steps), DC Motors (continuous rotation).
  5. CONTROLLER BOARD IMPLEMENTATION AND

    STRATEGY

    1. Controller Boards
        • ESP32/ESP32-S3: Chosen for high processing speed (dual-core), built-in Wi-Fi, and PWM support. Ideal for real-time control of servos (MG996R) and sensors.
        • Arduino Mega: Good for multi-axis arms due to high GPIO count.
        • STM32: Industrial-grade precision.
        • Raspberry Pi: Suitable for AI/Vision-based tracking.
    2. Strategy Used for Trajectory Tracking
        • PID Control: Ensures precise joint angle control by correcting present, past, and predicted errors.
        • Inverse Kinematics (IK): Converts desired coordinates into servo angles.
        • Sensor-Based Tracking: Uses IR Arrays for line detec- tion and TCS3200 for sorting.

          Fig. 2. Proposed Robotic Arm set-up

  6. DETAILS OF DESIGN WORKING & PROCESS

    Figure V-A illustrates the joint-space PID control perfor- mance of a two-link robotic manipulator. The desired joint trajectories q1d and q2d are sinusoidal functions, while q1 and q2 represent the corresponding actual joint responses obtained using the PID controller.

    The results demonstrate that both joints accurately track their desired trajectories throughout the simulation duration. A small transient deviation is observed during the initial phase, primarily due to system inertia and initial conditions. However, the controller quickly compensates for this deviation, resulting in rapid convergence of the actual joint angles to their reference trajectories.

    The tracking performance shows minimal overshoot and negligible steady-state error, indicating appropriate tuning of the proportional, integral, and derivative gains. The smooth and continuous joint responses confirm the stability of the closed- loop system and the absence of oscillatory behavior. Furthermore, the controller effectively handles the nonlinear dynamics and coupling effects inherent in the two-link ma- nipulator.

    1. Working Procedure
      1. Power ON and Initialization: Switch ON 12V battery. Buck converters regulate voltage (3A/5A). ESP32 ini- tializes sensors and servos.
      2. Line Following: The 6-channel IR array detects the line. ESP32 calculates position and drives DC motors via L298N to maintain the path.

        Fig. 4. Robotic arm position tracking

        Fig. 3. Circuit Diagram

      3. Object Detection: Front IR sensor detects an object. ESP32 stops motors. OLED displays status.
      4. Arm Movement: Robot stops; Arm moves TCS3200 sensor over the object.
      5. Colour Detection: Sensor identifies blue or green. ESP32 processes this data.
      6. Pick and Place: Based on color, the arm picks the object and places it to the right (blue) or left (green) using precise servo movements.
      7. Resume Line Following: Arm returns to home position. Robot resumes navigation.
      8. Continuous Operation: The cycle repeats for every object on the trajectory.
  7. RESULT AND SIMULATION

    TABLE I

    Performance Indices of Joint-Space PID Controller

    Index q q

    The project demonstrates how embedded systems and con- trol theory merge to create intelligent robotic solutions. The inclusion of sensors such as encoders and IR arrays en- hances feedback and enables the system to adapt dynamically. Meanwhile, the use of microcontrollers like ESP32 ensures seamless communication. This harmonious integration lays the foundation for advanced robotics and automation systems suitable for industrial, medical, and service applications.

    REFERENCES

    1. Trinh T. K. Ly, Nguyen H. Thai, and Luu T. Phong, Design of neural network-PID controller for trajectory tracking of differential drive mobile robot, Vietnam Journal of Science and Technology, vol. 62, no. 2, pp. 374386, Mar. 2024
    2. D. A. Mindell, Digital Apollo: Human and Machine in Spaceflight.

      Cambridge, MA, USA: MIT Press, 2019

    3. S. M. Sze and K. K. Ng, Physics of Semiconductor Devices, 3rd ed. Hoboken, NJ, USA: Wiley, 2020.
    4. K. J. A stro¨m and R. M. Murray, Feedback Systems: An Introduction for Scientists and Engineers. Princeton, NJ, USA: Princeton University Press, 2019.
    5. K. C apek, R.U.R. (Rossums Universal Robots). Prague, Czech Repub- lic, 1920.
    6. B. Siciliano and O. Khatib, Springer Handbook of Robotics, 2nd ed. Cham, Switzerland: Springer, 2016.
    7. J. J. Craig, Introduction to Robotics: Mechanics and Control, 3rd ed. Upper Saddle River, NJ, USA: Pearson, 2005.
    8. Siciliano, B., Sciavicco, L., Villani, L., and Oriolo, G., Robotics: Modelling, Planning and Control, Springer, 2009

    1 2 [9] Z.-H. Jiang and T. Ishida, A Neural Network Controller for Trajectory

    Rise time tr (s) 0.85 0.78

    Settling time ts (s) 1.9 1.7

    Overshoot Mp (%) 4.6 3.9

    Steady-state error ess (rad) 0 0

    IAE 0.42 0.38

    ISE 0.31 0.27

    ITAE 0.96 0.88

  8. CONCLUSIONS

The trajectory tracking robotic arm represents a significant advancement in modern automation, combining precision en- gineering, intelligent control algorithms, and real-time sensing capabilities to achieve highly accurate path-following perfor- mance. Throughout its development, the primary goal has been to ensure that the arm can follow predefined trajectories smoothly, efficiently, and reliably, even under varying load conditions and environmental disturbances.

Control of Industrial Robot Manipulators, J. Comput., vol. 3, no. 8, 2008.

  1. P. Ouyang, W. Zhang, and M. M. Gupta, An adaptive switching learning control method for trajectory tracking of robot manipulators, Mechatronics, vol. 16, no. 1, pp. 5161, 2006.
  2. Y. Pan, H. Yu, and X. Li, Trajectory tracking control of autonomous mobile robots: A review, IEEE Transactions on Industrial Electroics, vol. 69, no. 1, pp. 114, Jan. 2022.
  3. J. J. Craig, Introduction to Robotics: Mechanics and Control, 3rd ed. Upper Saddle River, NJ, USA: Pearson, 2005.
  4. K. C apek, R.U.R. (Rossums Universal Robots). Prague, Czech Repub- lic, 1920.
  5. Y. Pan, H. Yu, and X. Li, Trajectory tracking control of autonomous mobile robots: A review, IEEE Transactions on Industrial Electronics, vol. 69, no. 1, pp. 114, Jan. 2022.
  6. M. W. Spong, S. Hutchinson, and M. Vidyasagar, Robot Modeling and Control, Wiley, 2006.
  7. K. Ogata, Modern Control Engineering, 5th ed., Prentice Hall, 2010.
  8. Shadmehr, R., and Wise, S., The Computational Neurobiology of

    Reaching and Pointing: A Foundation for Motor Learning, MIT Press, 2005. (For motion-profile and trajectory-generation concepts)

  9. I. Carlucho, M. De Paula, and G.G. Acosta, An adaptive deep rein- forcement learning approach for MIMO PID control of mobile robots, ISA Transactions, 2020.
  10. H. Wang, Adaptive control of robot manipulators with uncertain kine- matics and dynamics, IEEE Transactions on Automatic Control, vol. 62, 2016.
  11. V. Santibanez and R. Kelly, PD control with feedforward compensation for robot manipulators: analysis and experimentation, Robotica, vol. 19, no. 1, pp. 1119, 2001.
  12. G. Boschetti and T. Sinico, Designing digital twins of robots using simscape multibody, Robotics, vol. 13, no. 4, p. 62, Apr. 2024.
  13. S. Jenhani, H. Gritli, and G. Carbone, Comparison between some nonlinear controllers for the position control of Lagrangian-type robotic systems, Chaos Theory Appl., vol. 4, no. 4, pp. 179196, Dec. 2022.
  14. D. Jorge, G. Pizzuto, and M. Mistry, Efficient learning of inverse dy- namics models for adaptive computed torque control, in Proc. IEEE/RSJ Int. Conf. Intell. Robots Syst. (IROS), Oct. 2022, pp. 1120311208.