top of page

Best Robotics Hardware in 2025: Essential Components, Boards & Sensors Compared

Ultra-realistic photo of best robotics hardware 2025—Raspberry Pi 5, Arduino Uno, HC-SR04 ultrasonic sensor, L298N motor driver—on workbench; boards & sensors comparison theme image.

The Paradox Every Robot Builder Faces

You're staring at dozens of browser tabs—Arduino Uno, Raspberry Pi 5, NVIDIA Jetson, ESP32—and the question loops in your head: Which one do I actually need?


The robotics forums say "it depends." YouTube reviews contradict each other. One article insists Arduino is best for beginners; another claims Raspberry Pi is easier if you know Python. Someone spent $800 on a Jetson Nano only to realize their obstacle-avoidance robot could've worked with a $5 ultrasonic sensor.


Here's the truth: Most beginners abandon robotics projects not because they lack skill, but because they chose the wrong hardware for their specific needs. A $20 Arduino can't run computer vision. A $99 Jetson is overkill for blinking an LED. And that "beginner-friendly" kit you bought? It might use components you'll never need.


This guide cuts through the noise. You'll learn exactly which board, sensor, and motor controller matches your project—whether you're building your first line-following robot or prototyping an autonomous rover. No fluff. No affiliate-driven hype. Just research-backed best robotics hardware recommendations with real prices, verified specs, and honest trade-offs.


Bottom line: By the end of this guide, you'll know whether you need a Raspberry Pi or an Arduino (or both), which IMU won't drift mid-project, and how to avoid the $200 LiDAR mistake most beginners make.




FTC Affiliate Disclosure

Transparency First: Some links in this guide are affiliate links. If you purchase through them, we may earn a small commission at no extra cost to you. Every product here is recommended based on thorough research of specifications, user reviews from verified sources, and technical documentation—not marketing hype. We only feature hardware that meets genuine robotics development needs.


Table of Contents

TL;DR — Quick Best Robotics Hardware Picks


Best Overall: Raspberry Pi 5

  • Best For: Full Linux robotics projects, computer vision, ROS2

  • Key Specs: Quad-core Cortex-A76 @ 2.4GHz, up to 16GB RAM, PCIe 2.0

  • Pros: Massive community, excellent documentation, Linux compatibility

  • Cons: Higher power consumption, requires cooling

  • Price: Starting at ~$50-80 (checked October 15, 2025; varies by RAM configuration)


Best for AI/Robotics: NVIDIA Jetson Orin Nano

  • Best For: Edge AI, computer vision, autonomous robots

  • Key Specs: 40 TOPS AI performance, Ampere GPU, 4-8GB RAM

  • Pros: Powerful GPU, CUDA support, excellent for ML inference

  • Cons: Premium price, steeper learning curve

  • Price: ~$99 developer kit (checked October 15, 2025, per Jaycon July 2025 report)


Best for Beginners: Arduino Uno R4 WiFi / UNO Q

  • Best For: Learning embedded systems, simple sensor projects

  • Key Specs: Microcontroller-based, built-in WiFi, extensive I/O

  • Pros: Simple to learn, huge library ecosystem, affordable

  • Cons: Limited processing power, no full OS

  • Price: ~$27-44 (R4 WiFi ~$27; new UNO Q ~$44, per October 2025 announcements)


Best Budget MCU: ESP32-S3

  • Best For: IoT robotics, WiFi/Bluetooth projects, power efficiency

  • Key Specs: Dual-core, WiFi 6, BLE 5.2, low power

  • Pros: Extremely affordable ($5-10), wireless built-in, low power

  • Cons: Limited RAM, less beginner-friendly than Arduino

  • Price: ~$5-10 (checked October 15, 2025, per Jaycon report)


Best IMU: Adafruit BNO055

  • Best For: Stable orientation tracking, sensor fusion

  • Key Specs: 9-DOF, hardware sensor fusion, I2C

  • Pros: Built-in calibration, quaternion output, stable

  • Cons: Calibration can be finicky, ~$20 price point

  • Price: ~$20 (excluding shipping; noted in April 2022 user experience)


Best Budget IMU: MPU6050

  • Best For: Cost-sensitive projects, learning

  • Key Specs: 6-DOF (accel + gyro), I2C, 16-bit ADC

  • Pros: Very affordable (~$2-5), widely documented

  • Cons: Requires external sensor fusion, drift issues

  • Price: ~$2-5 (checked October 15, 2025; varies by vendor)


Best LiDAR (Budget): Slamtec RPLidar A1

  • Best For: 2D mapping, obstacle detection

  • Key Specs: 360°, 12m range, 8000 samples/sec

  • Pros: Proven reliability, good range, affordable for LiDAR

  • Cons: 2D only, larger size

  • Price: Price varies—check current listings (no verified October 2025 price available)


Best LiDAR (Advanced): Livox Mid-360

  • Best For: 3D mapping, outdoor robotics

  • Key Specs: 360° horizontal, 59° vertical FOV, 70m range, detects at 10cm minimum

  • Pros: Omnidirectional, excellent outdoor performance

  • Cons: Premium price

  • Price: Price varies—check manufacturer (Livox official specs)


Best Ultrasonic: HC-SR04

  • Best For: Close-range obstacle detection (2-400cm)

  • Key Specs: 40kHz, 3mm accuracy, 4-pin interface

  • Pros: Dirt cheap (~$1-3), simple to use

  • Cons: Narrow beam angle (~15°), affected by soft surfaces

  • Price: ~$1-3 per unit (checked October 15, 2025, per Indian retailer listings)


Best H-Bridge: L298N Dual Motor Driver

  • Best For: Driving 2 DC motors, robot vehicles

  • Key Specs: 2A per channel, 5-35V input, dual H-bridge

  • Pros: Affordable (~$3-8), easy to use, built-in 5V regulator

  • Cons: 2V voltage drop, heat dissipation at high current

  • Price: ~$3-8 (checked October 15, 2025; varies by vendor)


Comparison Table

Component

Best For

Key Specs

Pros

Cons

Price (USD, Oct 2025)

Where to Buy

Raspberry Pi 5

Full robotics OS

Quad-core A76 2.4GHz, 4-16GB RAM

Linux, huge community

Power hungry

~$50-80

NVIDIA Jetson Orin Nano

AI/Vision

40 TOPS, Ampere GPU

Powerful ML, CUDA

Expensive, complex

~$99 kit

Arduino Uno R4 WiFi

Beginners

ATmega328P equivalent, WiFi

Simple, huge libs

No OS, limited RAM

~$27

Arduino UNO Q

Hybrid projects

Qualcomm QRB2210 + MCU, 2-4GB RAM

SBC + MCU combo

New, limited support

$44-59

ESP32-S3

IoT robotics

Dual-core, WiFi 6, BLE

Cheap, wireless

Limited RAM

~$5-10

Various distributors

Adafruit BNO055

Orientation

9-DOF, sensor fusion

Stable, easy

Calibration time

~$20

MPU6050

Budget IMU

6-DOF, I2C

Very cheap

Drift, no mag

~$2-5

Amazon, AliExpress

Livox Mid-360

3D LiDAR

360°×59° FOV, 70m

Omnidirectional

Premium

Varies

HC-SR04

Ultrasonic

2-400cm, 40kHz

Ultra cheap

Narrow beam

~$1-3

Ubiquitous

L298N Driver

Motor control

2A/ch, dual H-bridge

Affordable, easy

Voltage drop

~$3-8

Amazon, RobotShop

How to Read This Table:

  • Price ranges reflect typical online prices as of October 15, 2025, subject to regional variations and sales.

  • "Best For" indicates the primary use case where each component excels.

  • Pros/Cons are based on documented user experiences and technical limitations from manufacturer specs and independent reviews.

  • TOPS = Tera Operations Per Second, a measure of AI computing performance.

  • Components with "Varies" pricing indicate fluctuating market rates or custom configurations—always verify current prices before purchasing.


In-Depth: Development Boards


Raspberry Pi 5

What It Is:

The Raspberry Pi 5 is a single-board computer (SBC) running full Linux distributions. Released in 2023-2024, it's the most powerful consumer Raspberry Pi to date.


Why It Stands Out:

According to Jaycon's July 2025 report, the Pi 5 features a quad-core Cortex-A76 CPU at 2.4GHz, up to 16GB LPDDR4X RAM, dual HDMI 4Kp60 outputs, and a PCIe 2.0 x1 slot—a first for Raspberry Pi. This PCIe slot enables NVMe SSDs and expansion cards for storage or connectivity upgrades.


Key Specs & Real-World Performance:

  • CPU: Broadcom BCM2712, quad-core Cortex-A76 @ 2.4GHz

  • RAM: 4GB, 8GB, or 16GB LPDDR4X configurations

  • Connectivity: Dual USB 3.0, dual USB 2.0, Gigabit Ethernet, dual-band 802.11ac Wi-Fi, Bluetooth 5.0/BLE

  • GPIO: Standard 40-pin header (backward compatible)

  • Storage: MicroSD + PCIe for NVMe drives

  • Cooling: Active cooling required under sustained loads


Electromaker notes that Raspberry Pi remains the most popular SBC globally, with extensive community support, thousands of tutorials, and compatibility with robotics frameworks like ROS 2.


Who It's For / Not For:

  • For: Robotics students, researchers, makers building vision-based robots, anyone needing full Linux with GPIO

  • Not For: Battery-powered robots (high power draw), ultra-low-latency real-time control (use an MCU instead)


Common Gripes:

  • Heat: Pi 5 runs hot; Jaycon reports active cooling is essential for sustained performance.

  • Supply: Historically plagued by shortages, though availability improved by late 2024.

  • No built-in real-time: GPIO timing isn't as precise as dedicated microcontrollers.


Alternatives:

  • Rock Pi 4 Model B: Similar specs, lower cost, but smaller community (Electromaker comparison).

  • Orange Pi 5: Budget alternative with RK3588 SoC; less software support.


Price & Availability:

The Raspberry Pi 5 starts around $50-80 USD depending on RAM configuration (4GB ~$50, 8GB ~$65, 16GB ~$80). Prices vary by region and retailer. Always verify current stock at raspberrypi.com or authorized distributors like Adafruit, SparkFun, or CanaKit.


Sustainability Notes:

  • Power Consumption: ~5-10W typical, up to 15W under load (higher than Pi 4)

  • Repairability: Modular design; community supports unofficial repairs

  • Certifications: CE, FCC compliant; no specific environmental certifications verified


NVIDIA Jetson Orin Nano

What It Is:The Jetson Orin Nano is NVIDIA's entry-level AI edge computer, targeting robotics and autonomous systems requiring real-time computer vision and machine learning inference.


Why It Stands Out:

According to Hackster.io's July 2025 review, the Orin Nano delivers 40 TOPS (Tera Operations Per Second) of AI performance with an integrated Ampere-class GPU, far exceeding previous-generation Jetson Nano while maintaining a similar developer kit price (~$99). The board supports CUDA, cuDNN, TensorRT, and NVIDIA's Deepstream SDK for optimized video analytics.


Key Specs:

  • GPU: Ampere architecture, 1024 CUDA cores, 32 Tensor cores

  • CPU: 6-core Arm Cortex-A78AE @ 1.5GHz

  • RAM: 4GB or 8GB LPDDR5

  • Connectivity: PCIe Gen3, USB 3.2, MIPI CSI camera interfaces, Ethernet

  • Power: 7-15W configurable TDP


ThinkRobotics (September 2024) highlights the Orin Nano's ability to run advanced neural networks like YOLO for object detection and Transformer models for natural language processing, all locally without cloud dependence.


Who It's For / Not For:

  • For: Advanced robotics engineers, autonomous vehicle developers, anyone running real-time AI inference

  • Not For: Absolute beginners (steep learning curve), projects without AI/vision needs (overkill)


Common Gripes:

  • Cost: At ~$99 for the dev kit (4GB model), it's pricier than a Raspberry Pi but justified for AI workloads.

  • Cooling: Requires heatsink/fan under sustained inference loads.

  • Software Complexity: JetPack SDK and containerized workflows have a steeper learning curve than Raspberry Pi OS.


Alternatives:

  • Raspberry Pi 5: Far cheaper, but 1/40th the AI performance.

  • Coral Dev Board: Google's Edge TPU offers 4 TOPS for ~$130, but less flexible than NVIDIA's ecosystem (Jaycon comparison).


Price & Availability:

Developer kit pricing: ~$99 USD (4GB) as of October 15, 2025, per Jaycon's July 2025 report. Check NVIDIA's official store for current availability.


Sustainability:

  • Power Efficiency: Configurable 7-15W TDP; efficient for AI workloads

  • Lifecycle: NVIDIA typically supports Jetson products for 5-10 years


Arduino Uno R4 WiFi / UNO Q

What It Is:

The Arduino Uno R4 WiFi is the WiFi-enabled evolution of the classic Uno, designed for beginners and embedded control. In October 2025, Qualcomm announced the acquisition of Arduino, introducing the Arduino UNO Q—a hybrid board combining a Qualcomm Dragonwing QRB2210 SoC (running Linux) with an STM32U575 microcontroller in the classic Uno form factor.


Why They Stand Out:

  • Uno R4 WiFi: Maintains Arduino's beginner-friendly IDE and libraries while adding WiFi connectivity. Ideal for IoT sensor projects.

  • UNO Q: The UNO Q ($44, shipping October 24, 2025) bridges the gap between MCU simplicity and SBC power, offering 2GB RAM, 16GB eMMC, WiFi, Bluetooth, and 47 digital I/O pins—essentially an SBC with Arduino's ease-of-use.


Key Specs:

  • Uno R4 WiFi: ESP32-S3-based, 14 digital I/O, 6 analog inputs, USB-C

  • UNO Q: Qualcomm QRB2210 (quad-core Cortex-A53 @ 2GHz), 2GB LPDDR4, 16GB eMMC, 47 I/O pins, runs Debian Linux


Who It's For / Not For:

  • For: Beginners learning embedded systems, educators, makers needing simple sensor control

  • Not For: High-performance computing, complex vision tasks (use Raspberry Pi or Jetson instead)


Common Gripes:

  • Limited RAM: Uno R4 WiFi has minimal RAM compared to SBCs.

  • UNO Q Unknowns: As a brand-new product (announced October 2025), long-term Linux support from Qualcomm is uncertain (Jeff Geerling's concerns).


Price & Availability:

  • Uno R4 WiFi: ~$27 USD (October 2025, per Geerling)

  • UNO Q: $44 USD (2GB/16GB), $59 USD (4GB/32GB) (The Register, October 2025)


Accessibility:

Arduino's IDE and block-based programming (via Arduino Cloud) make it highly accessible for students and those new to coding.


ESP32-S3

What It Is:

The ESP32-S3 is a low-cost, dual-core microcontroller with integrated WiFi 6 and Bluetooth 5.2, developed by Espressif Systems.


Why It Stands Out:

Electromaker's 2025 guide highlights the ESP32-S3's dual-core Xtensa LX7 processors, support for TinyML (machine learning on-device), and ultra-low power modes—ideal for battery-powered IoT robotics.


Key Specs:

  • CPU: Dual-core Xtensa LX7 @ up to 240MHz

  • Wireless: WiFi 6 (802.11ax), Bluetooth 5.2 (Classic + BLE)

  • Memory: 512KB SRAM, 384KB ROM (external flash supported)

  • GPIO: Up to 45 programmable pins (varies by module)

  • Price: ~$5-10 USD per dev module


Who It's For / Not For:

  • For: Budget-conscious makers, IoT projects, WiFi-enabled sensors, small robots

  • Not For: Heavy computation, Linux-based projects, beginners preferring Arduino's simplicity


Common Gripes:

  • Documentation: Less beginner-friendly than Arduino; ESP-IDF (Espressif's SDK) has a steeper learning curve.

  • RAM Limits: 512KB SRAM constrains complex applications.


Price: ~$5-10 USD for dev boards like the ESP32-S3-DevKitC (October 2025, per Jaycon).


In-Depth: Sensors


Adafruit BNO055 (9-DOF IMU)

What It Is:

The BNO055 is a 9-degree-of-freedom (9-DOF) Inertial Measurement Unit combining a 3-axis accelerometer, 3-axis gyroscope, and 3-axis magnetometer with on-chip sensor fusion—meaning it outputs orientation as quaternions or Euler angles without requiring external processing.


Why It Stands Out:

A robotics developer (April 2022) compared the BNO055 to the cheaper MPU6050 and found the BNO055 "night and day" more stable, with automatic calibration and noise filtering handled in hardware. Unlike the MPU6050, which requires implementing sensor fusion algorithms (like Madgwick or Complementary filters) in software, the BNO055 does this internally.


Key Specs:

  • Sensor Fusion: Built-in NDOF (9-axis) fusion @ 100Hz output

  • Outputs: Quaternions, Euler angles, linear acceleration, gravity vector, heading

  • Interface: I2C (0x28 or 0x29 address)

  • Calibration: Auto-calibrates gyro in 8 seconds of stillness; accelerometer factory-calibrated; magnetometer requires motion (Autominy docs, July 2025)


Who It's For / Not For:

  • For: Robotics requiring stable orientation (drones, balancing robots, AR/VR headsets), ROS 2 projects

  • Not For: Ultra-budget builds (the MPU6050 costs 1/4 the price); high-vibration environments (magnetometer can be unreliable)


Common Gripes:

  • Magnetometer Calibration: Users report achieving full calibration (system, gyro, accel, mag all at "3") can take significant time and requires rotating the sensor in specific patterns. Calibration offsets cannot be easily saved/restored.

  • Mounting: Best mounted on removable brackets for easy calibration (RoboFoundry tip).


Alternatives:

  • BNO085: Updated firmware, similar hardware; check compatibility with existing libraries.

  • LSM6DSOX + LIS3MDL: ST Microelectronics combo; requires external fusion but offers flexibility.


Price: ~$20 USD (excluding shipping) as of April 2022 user experience; verify current pricing at Adafruit.


Setup Tips:Use I2C address scanner to confirm 0x28 default; ensure stable 3.3V or 5V power; connect to I2C bus with pullup resistors if needed. See Automatic Addison's ROS tutorial for NVIDIA Jetson/Raspberry Pi wiring.


MPU6050 (6-DOF IMU)

What It Is:

The MPU6050 is a low-cost 6-DOF IMU combining a 3-axis accelerometer and 3-axis gyroscope. Unlike the BNO055, it does not include sensor fusion—you must implement this in software.


Why It Stands Out:

Adafruit describes it as "an oldie but goodie"—a staple in electronics projects due to its ultra-low price (~$2-5) and extensive Arduino library support. Despite being older technology, it remains widely used for learning and budget-conscious projects.


Key Specs:

  • Accelerometer: ±2g/±4g/±8g/±16g selectable full-scale range

  • Gyroscope: ±250/±500/±1000/±2000 deg/sec

  • Interface: I2C (0x68 or 0x69 address)

  • On-Chip DMP: Digital Motion Processor (requires reverse-engineered firmware to enable)


Who It's For / Not For:

  • For: Learning IMU basics, budget robotics, projects where drift is acceptable

  • Not For: Applications requiring stable long-term orientation (use BNO055); high-precision navigation (LiDAR or GPS needed)


Common Gripes:

  • Drift: Users report gyroscope drift over time, requiring periodic recalibration.

  • No Magnetometer: Cannot determine absolute heading (only relative orientation).

  • Sensor Fusion Required: You must implement Kalman, Madgwick, or Complementary filters to combine accel/gyro data into stable orientation estimates.


Alternatives:

  • BNO055: 3x-4x the price, but far more stable with built-in fusion.

  • ICM-20948: Newer 9-DOF chip from InvenSense (MPU6050's successor).


Price: ~$2-5 USD per module (October 2025, based on Amazon listings and Indian vendor pricing at ₹183 (~$2.20 USD)).


Setup Tips:

Run calibration routine to find accel/gyro offsets; mount rigidly to minimize vibration noise; use library like MPU6050_light (Arduino) or Adafruit_MPU6050 (CircuitPython).


Slamtec RPLidar A1 (2D LiDAR)

What It Is:

The RPLidar A1 is a 360-degree 2D laser scanner designed for indoor robot navigation, mapping, and SLAM (Simultaneous Localization and Mapping).


Why It Stands Out:

RobotShop describes the RPLidar series as affordable 2D LiDAR with proven reliability in educational and hobby robotics. The A1 scans at up to 8,000 samples/second with 12-meter range, sufficient for most indoor mobile robots.


Key Specs:

  • Range: 0.15m to 12m

  • Scan Rate: 5.5Hz (330 RPM)

  • Sample Rate: ~8,000 samples/sec

  • Interface: USB or UART

  • Dimensions: Compact spinning design


Who It's For / Not For:

  • For: Indoor robots, SLAM beginners, education

  • Not For: Outdoor use (limited range, affected by sunlight); 3D mapping (use 3D LiDAR instead)


Price & Availability:

Pricing not verified for October 2025. Historical pricing ~$99-150 USD; check Slamtec official store or distributors like RobotShop.


Livox Mid-360 (3D LiDAR)

What It Is:

The Mid-360 is a compact 3D LiDAR sensor with 360° horizontal and 59° vertical field of view, designed for low-speed robotics like mobile service robots and autonomous ground vehicles.


Why It Stands Out:

According to Livox's official specs, the Mid-360 achieves omnidirectional 3D perception with a minimum detection range of just 10cm and maximum range of 70m for 80% reflective objects. It uses Livox's hybrid-solid rotating mirror technology (no traditional mechanical spinning), improving durability and reducing blind spots.


Key Specs:

  • FOV: 360° horizontal × 59° vertical (near-omnidirectional)

  • Range: 0.1m to 70m (80% reflectivity targets)

  • Detection: Unaffected by bright or low-light environments; reliable indoors and outdoors

  • Multiple LiDAR Interference: Can operate alongside other LiDARs without signal interference


Who It's For / Not For:

  • For: Advanced mobile robots, warehouse AGVs, outdoor navigation, 3D mapping

  • Not For: Budget projects (premium price); hobbyists just learning LiDAR (start with 2D)


Price: Pricing not disclosed publicly on Livox's site as of October 15, 2025. Contact Livox or authorized distributors for quotes.


Use Cases:

Livox highlights indoor whole-house scanning (for cleaning robots) and outdoor dynamic scanning under 100Klux strong light (for autonomous vehicles).


HC-SR04 Ultrasonic Sensor

What It Is:

The HC-SR04 is a budget ultrasonic distance sensor using 40kHz sound waves to measure distances from 2cm to 400cm.


Why It Stands Out:

Robocraze markets it as the go-to sensor for beginners due to its ultra-low cost (~$1-3) and 4-pin simplicity (VCC, GND, Trig, Echo). SparkFun notes it offers ranging accuracy up to 3mm, making it suitable for basic obstacle avoidance in hobby robots.


Key Specs:

  • Range: 2cm to 400cm (effective range)

  • Accuracy: ±3mm

  • Beam Angle: ~15° (relatively narrow)

  • Interface: Digital Trig/Echo pins (5V logic)

  • Power: 5V DC, <15mA


Who It's For / Not For:

  • For: Budget robots, learning distance sensing, short-range obstacle detection

  • Not For: Precision measurement (use LiDAR or ToF sensors); outdoor/long-range (limited by beam angle and weather)


Common Gripes:

  • Narrow Beam: 15° cone means small objects can be missed.

  • Soft Surfaces: ElectroPeak warns acoustically soft materials (cloth, foam) may not reflect ultrasonic waves effectively.

  • Outdoor Limitations: Performance degrades in wind, temperature extremes, or high humidity.


Alternatives:

  • VL53L0X Time-of-Flight: Laser-based, narrower beam, more accurate, but shorter range (2m max).

  • MaxBotix Ultrasonic: Higher-quality, wider voltage range, but 5x-10x the cost.


Price: ~$1-3 USD per unit (October 2025, per Robocraze at ₹56 (~$0.67 USD) and Skynet Robotics at ₹55 (~$0.66 USD)). Prices vary; bulk orders reduce per-unit cost.


Setup: Connect VCC to 5V, GND to ground, Trig to digital output, Echo to digital input (use voltage divider for 3.3V systems like Raspberry Pi). See SparkFun's hookup guide.


In-Depth: Motor Controllers


L298N Dual H-Bridge Motor Driver

What It Is:

The L298N is a dual-channel H-bridge motor driver module based on the ST Microelectronics L298N chip, designed to control two DC motors or one stepper motor.


Why It Stands Out:

ProtoSupplies (November 2024) describes the L298N as the "go-to module for beginners" due to its straightforward logic, affordable price (~$3-8), and built-in 5V regulator that can power an Arduino directly (when input voltage is 7-12V).


Key Specs:

  • Motor Channels: 2 independent channels (A and B)

  • Continuous Current: 2A per channel (2.5A peak, 25W total)

  • Voltage Range: 5-35V input (7-12V recommended for using onboard 5V regulator)

  • Control: 4 digital inputs (IN1-IN4) for direction, 2 enable pins (ENA/ENB) for PWM speed control

  • Protection: Flyback diodes for inductive kickback protection


Real-World Performance:

ProtoSupplies notes a ~2V voltage drop through the L298N driver, meaning if you supply 12V, motors receive ~10V. This drop becomes significant at lower voltages, reducing motor torque. The module includes heatsinks to dissipate heat at higher currents, but prolonged 2A+ operation can cause overheating without additional cooling.


Who It's For / Not For:

  • For: Beginner robots, Arduino/Raspberry Pi motor control, low-cost wheeled vehicles

  • Not For: High-efficiency applications (modern MOSFET drivers like TB6612FNG have <0.5V drop); high-current motors >2A continuous


Common Gripes:

  • Voltage Drop: 2V loss reduces available motor voltage and torque.

  • Heat: Can get hot at high currents; requires heatsink or cooling.

  • No Current Limiting: Lacks built-in overcurrent protection; motors can stall and overheat the chip.


Alternatives:

  • TB6612FNG: Modern MOSFET-based driver, 1.2A continuous, <0.5V drop, but less current capacity.

  • Pololu DRV8833: Dual motor driver, 1.2A per channel, more efficient.

  • Cytron MDD10A: 10A continuous, but 3x-5x the cost.


Price: ~$3-8 USD per module (October 2025, based on various vendor listings). Prices vary by vendor and region; bulk purchases reduce cost.


Setup Tips:

ProtoSupplies recommends using PWM on ENA/ENB for speed control and digital HIGH/LOW on IN1-IN4 for direction. Do NOT apply voltage to both VCC (motor power) and 5V terminals simultaneously—damage will result. For 7-12V VCC, use the onboard 5V terminal to power your Arduino (up to 400mA).


Safety:

Always add fuses on motor power lines to prevent overcurrent damage. Use proper wire gauge for motor currents (e.g., 18-20 AWG for 2A).


Buyer's Guide


Key Decision Factors

1. Project Complexity:

  • Simple sensor projects, LED control: Arduino Uno R4 or ESP32

  • Computer vision, ROS 2, Linux: Raspberry Pi 5 or Jetson Orin Nano

  • AI inference, autonomous navigation: Jetson Orin Nano

  • Hybrid (MCU + Linux): Arduino UNO Q


2. Power Budget:

  • Battery-powered: ESP32 (low power modes), Arduino (moderate), avoid Pi 5/Jetson without large batteries

  • Wall-powered: Any board works; prioritize performance over efficiency


3. Sensor Needs:

  • Orientation/IMU: BNO055 (stable, easy) or MPU6050 (budget, requires fusion code)

  • Distance sensing: HC-SR04 (ultra-cheap, 2-400cm), LiDAR (long-range, mapping)

  • 3D mapping: Livox Mid-360 or similar 3D LiDAR

  • Vision: USB/MIPI cameras with Raspberry Pi or Jetson


4. Budget Tiers:

  • Under $50: ESP32 + MPU6050 + HC-SR04 + L298N = ~$15-25

  • $50-150: Raspberry Pi 5 + BNO055 + HC-SR04 + L298N = ~$80-110

  • $150-300: Jetson Orin Nano + BNO055 + RPLidar A1 + motor driver = ~$200-270

  • $300+: Jetson Orin + Livox Mid-360 + advanced sensors


5. Community & Support:

  • Largest communities: Raspberry Pi, Arduino

  • Growing communities: ESP32, Jetson (NVIDIA AI Lab)

  • Niche/smaller: Rock Pi, Orange Pi (fewer tutorials)


What's New in 2024-2025

Hardware:

  • Qualcomm acquired Arduino (October 2025), launching the UNO Q hybrid SBC/MCU board.

  • Renesas RZ/V2H announced (July 2025) with 100 TOPS AI performance—most powerful edge AI SoC as of mid-2025.

  • LiDAR pricing dropping: Entry-level automotive LiDAR now $150-300 (down from $600+), with solid-state LiDAR expected to reduce costs by 50% over next few years.


Software:

  • ROS 2 Jazzy released (May 2024), improving real-time performance.

  • TensorRT 10 (NVIDIA) offers faster inference on Jetson platforms.


Standards & Safety:

  • ISO 13849 (Safety of Machinery) increasingly adopted for robotic arms and AGVs.

  • IEC 62443 (Industrial Cybersecurity) relevant for networked robots.


What to Avoid

Pitfalls:

  1. Underpowered Motors: Match motor controller current rating to motor stall current (2x safety margin). The L298N's 2A limit is easily exceeded by larger motors.

  2. Voltage Mismatches: HC-SR04 outputs 5V logic; Raspberry Pi GPIO is 3.3V-tolerant. Use voltage dividers or level shifters.

  3. Fake Sensors: Clone MPU6050/BNO055 modules may have poor calibration or defective chips. Buy from reputable vendors (Adafruit, SparkFun, DFRobot).

  4. Ignoring Power Supply: Brownouts from insufficient current cause erratic behavior. Use separate power for motors (not Arduino's 5V regulator).

  5. LiDAR Overkill: If your robot only needs 2D obstacle detection, a $200+ 3D LiDAR is wasteful. Start with HC-SR04 or 2D LiDAR.


Compatibility:

  • Raspberry Pi 5 GPIO: Backward compatible with older Pi HATs, but check power draw (new 5V 5A PSU requirement).

  • Arduino Shields: UNO Q maintains Uno form factor, but not all shields guaranteed compatible with new dual-processor architecture.

  • I2C Conflicts: MPU6050 (0x68) and BNO055 (0x28) use different addresses, so no conflict. Always check sensor datasheets for address collisions.


Ecosystem Lock-In

NVIDIA Jetson:

  • Pros: Best-in-class AI performance, mature software stack

  • Cons: Proprietary SDK (JetPack), limited to NVIDIA hardware


Arduino:

  • Pros: Fully open-source (hardware and software), massive clone ecosystem

  • Cons: UNO Q's Qualcomm SoC support longevity uncertain


Raspberry Pi:

  • Pros: Open software, strong upstream Linux kernel support

  • Cons: Proprietary Broadcom SoC limits low-level hacking


Care, Maintenance & Longevity

Hardware:

  • Clean Sensors Regularly: Dust on ultrasonic transducers or LiDAR windows degrades performance.

  • Check Connections: Vibration loosens jumper wires; use crimped connectors or solder for permanent builds.

  • Thermal Management: Add heatsinks or fans to Raspberry Pi 5, Jetson, and L298N under sustained loads.


Software:

  • Update Firmware: Raspberry Pi, Jetson receive security patches; update regularly via apt update && apt upgrade.

  • Backup SD Cards: Raspberry Pi SD cards fail eventually; keep backups and use industrial-grade cards (SanDisk High Endurance) for 24/7 robots.


Longevity:

  • Raspberry Pi: 5-10 years of software support; hardware lasts until SD card or PSU fails.

  • Arduino: Virtually unlimited lifespan (simple hardware); ATmega chips rated for decades.

  • Sensors: MPU6050/BNO055 have no moving parts; lifespan primarily limited by solder joint fatigue from vibration.

  • LiDAR: Mechanical LiDAR (spinning) may degrade after 5,000-10,000 hours; solid-state LiDAR (Mid-360) longer-lived.


Methodology & Editorial Integrity


How Products Were Selected

Criteria:

  1. Popularity & Proven Use: We prioritized components widely used in robotics education, research, and commercial products.

  2. Availability: All featured hardware must be purchasable from major distributors

  3. Price-Performance: We included budget, mid-range, and premium options across each category.

  4. Ecosystem Maturity: Strong community support, extensive documentation, and software libraries weighted heavily.


Data Sources:

  • Manufacturer specifications (Raspberry Pi Foundation, NVIDIA, Arduino, Bosch Sensortec, ST Microelectronics, Livox, etc.)

  • Independent testing and reviews from:

  • User experiences documented in:

    • RoboFoundry Medium post

    • Jeff Geerling blog

    • Automatic Addison tutorials


  • Retailer pricing from Amazon, Adafruit, SparkFun, RobotShop, RobocrCraze, and manufacturer stores


How Prices/Specs Were Verified

Pricing: Cross-referenced across:

  • Official manufacturer stores (when available)

  • Major electronics distributors (Adafruit, SparkFun, DigiKey, Mouser)

  • Online marketplaces (Amazon, AliExpress)


Prices are USD and exclude shipping/taxes unless noted. Regional pricing varies significantly (e.g., Indian INR prices converted to USD for comparison). We do not guarantee prices—always verify current pricing before purchase.


Specifications: All technical specs sourced from:

  • Official datasheets

  • Manufacturer documentation

  • Independent teardowns/reviews (when official data unavailable)


FAQs


Q1: What's the difference between Raspberry Pi and Arduino for robotics?

Raspberry Pi is a microprocessor-based single-board computer running a full Linux OS, suitable for complex tasks like computer vision, ROS 2, and multitasking. Arduino is a microcontroller optimized for real-time control of sensors and motors with simpler, single-task programs. TL;DR: Use Raspberry Pi for "robot brain" (planning, vision); use Arduino for "robot reflexes" (motor control, sensor reading).


Q2: Can I use Raspberry Pi GPIO to control motors directly?

No. Raspberry Pi GPIO pins output only 3.3V at <16mA per pin—far too weak to drive motors. You must use a motor driver like the L298N or TB6612FNG between the Pi and motors. ProtoSupplies explains motor drivers provide high-current H-bridge circuits to switch motor direction and speed via PWM from the Pi's low-power GPIO.


Q3: Which IMU is better: MPU6050 or BNO055?

BNO055 is objectively better for robotics requiring stable orientation (drones, balancing robots). A side-by-side comparison showed the BNO055's hardware sensor fusion delivers "night and day" more stable readings than the MPU6050, which requires manual sensor fusion and exhibits drift. However, MPU6050 costs 1/4 the price (~$2 vs. ~$20), making it ideal for learning or budget builds where absolute accuracy isn't critical.


Q4: Do I need a LiDAR for my robot?

Not always. LiDAR excels at long-range (>5m) obstacle detection and mapping, but costs $100-$1,000+. For simple obstacle avoidance at <4m, ultrasonic sensors like the HC-SR04 (~$1-3) suffice. IEEE Spectrum (2022) notes LiDAR is "arguably the best sensor we have right now for reliable navigation" in professional robots, but many hobby robots function fine with cheaper sensors.


Q5: Can the HC-SR04 ultrasonic sensor work outdoors?

Yes, but with limitations. ElectroPeak warns wind, temperature extremes, and humidity affect ultrasonic wave propagation, reducing accuracy. For outdoor robots, consider LiDAR or Time-of-Flight (ToF) sensors like the VL53L0X, which use laser light (unaffected by weather) but have shorter range.


Q6: What power supply do I need for Raspberry Pi 5?

Raspberry Pi 5 requires a 5V 5A (25W) USB-C power supply—significantly more than previous models (Pi 4: 5V 3A). Under heavy load (all USB ports active, PCIe drive, overclocking), it can draw 20W+. Use the official Raspberry Pi 27W USB-C PSU or equivalent to avoid brownouts.


Q7: How do I connect a 5V sensor (HC-SR04) to a 3.3V Raspberry Pi GPIO?

The HC-SR04's Echo pin outputs 5V, but Raspberry Pi GPIO is 3.3V tolerant (5V can damage pins). Use a voltage divider (two resistors: 1kΩ and 2kΩ) to drop Echo to 3.3V before connecting to Pi GPIO. See Robocraze's tutorial for wiring diagrams.


Q8: What's the difference between 2D and 3D LiDAR?

2D LiDAR (e.g., RPLidar A1) scans in a single horizontal plane (360° × 0°), creating a flat "slice" of the environment—ideal for indoor wheeled robots navigating on flat floors. 3D LiDAR (e.g., Livox Mid-360) adds vertical FOV (e.g., 59°), capturing obstacles above/below the sensor—essential for drones, stairs, uneven terrain, or 3D mapping.


Q9: Can I run ROS (Robot Operating System) on Arduino?

Not full ROS. ROS 2 requires Linux and significant RAM/CPU, which microcontrollers lack. However, micro-ROS (a stripped-down ROS 2 client) can run on Arduino/ESP32, allowing them to publish/subscribe to ROS topics on a connected PC or Raspberry Pi. For full ROS 2, use Raspberry Pi, Jetson, or similar Linux SBCs.


Q10: What's the difference between the L298N and TB6612FNG motor drivers?

  • L298N: Older bipolar H-bridge design, 2A per channel, ~2V voltage drop, includes 5V regulator, very cheap (~$3-8).

  • TB6612FNG: Modern MOSFET design, 1.2A per channel, <0.5V voltage drop, more efficient, but lower current capacity and slightly pricier (~$5-10).


Use L298N for higher-current motors; use TB6612FNG for efficiency and battery-powered robots.


Q11: Can the NVIDIA Jetson Orin Nano run on battery power?

Yes, but plan carefully. The Orin Nano's 7-15W TDP requires a robust battery. A 10,000mAh 5V USB power bank (~50Wh) can run it for 3-5 hours at moderate load. For outdoor autonomous robots, use LiPo batteries (e.g., 3S 11.1V, 5000mAh) with a voltage regulator to supply stable power.


Q12: What programming languages work with Raspberry Pi for robotics?

  • Python: Most popular for robotics (libraries: GPIO, OpenCV, ROS 2 rclpy). Easy to learn.

  • C++: Faster performance for real-time control (ROS 2 rclcpp, OpenCV).

  • Rust: Emerging language for embedded safety-critical systems.

  • Scratch: Visual block-based coding for education.


Q13: How accurate is the HC-SR04's 3mm precision claim?

In ideal conditions only. SparkFun states 3mm accuracy, but real-world factors degrade this: temperature changes sound speed; angled surfaces cause reflections to miss the receiver; soft materials absorb ultrasound. Expect ±1-2cm in typical use.


Q14: What's the minimum distance the Livox Mid-360 can detect?

Livox specs confirm 10cm (0.1m) minimum detection range, making it suitable for close-quarters navigation (e.g., moving through doorways, around furniture). Many cheaper LiDARs have 0.5-1m blind spots.


Q15: Do I need a heatsink for the Raspberry Pi 5?

Yes, under sustained loads. Jaycon's report notes Pi 5 runs hot; without active cooling, the CPU throttles at ~80°C, reducing performance. Use the official active cooler for best results, especially for computer vision or 24/7 operation.


Q16: Can I power Arduino and motors from the same battery?

Yes, but with caveats. Motors cause voltage spikes that can reset or damage Arduino. Best practice: Use a motor driver with separate power (motors on Vin, Arduino on 5V regulated output from L298N if using 7-12V battery). Add a capacitor (100μF) across motor terminals to suppress spikes. Never connect motors directly to Arduino's 5V or Vin pins.


Q17: What's the BNO055's calibration process?

Autominy docs (July 2025) explain: Accelerometer is factory-calibrated; gyroscope auto-calibrates after 8 seconds of stillness (typically during boot); magnetometer requires rotating the sensor through all axes (forming a "figure 8" motion). Calibration status is readable via I2C (0-3 for system, gyro, accel, mag). Achieving full "3" for all parameters can take minutes and is environment-dependent.


Q18: Can the ESP32 replace Arduino in my project?

Maybe. ESP32 is more powerful (dual-core, WiFi/Bluetooth), but the Arduino ecosystem's simplicity and library compatibility give it an edge for beginners. Arduino's IDE and shield ecosystem are unmatched. ESP32 requires using ESP-IDF or Arduino core for ESP32 (which adds complexity). If you need wireless, ESP32 wins; if you prioritize simplicity, stick with Arduino.


Q19: What's the expected lifespan of a microSD card in Raspberry Pi?

Standard SD cards fail after ~10,000-100,000 write cycles. In a Raspberry Pi running 24/7 (frequent disk writes), a cheap card may fail in months. Use industrial-grade endurance cards like SanDisk High Endurance or Samsung PRO Endurance, rated for continuous recording. Alternatively, boot from NVMe SSD via PCIe (Pi 5 only) for far greater longevity.


Q20: Why is LiDAR pricing dropping in 2025?

LiDAR pricing analysis (April 2025) attributes drops to solid-state LiDAR maturation, which eliminates expensive mechanical scanning systems. Mass production for automotive (Tesla, Waymo, etc.) drives economies of scale. Entry-level LiDAR that cost $600+ in 2023 now retail for $150-300, with further 50% drops expected as solid-state tech matures.


Setup, Safety & Troubleshooting


Step-by-Step Setup Checklist

For Raspberry Pi 5 + Robotics HAT:

  1. Flash OS: Download Raspberry Pi OS (64-bit recommended) using Raspberry Pi Imager.

  2. Boot & Update: sudo apt update && sudo apt full-upgrade -y

  3. Enable I2C/SPI: sudo raspi-config → Interface Options → Enable I2C, SPI, Serial

  4. Install GPIO Libraries: sudo apt install python3-gpiozero python3-rpi.gpio

  5. Connect Sensors: Use voltage dividers for 5V sensors (HC-SR04 Echo pin); direct connect for 3.3V sensors (BNO055)

  6. Power: Use official 27W USB-C PSU; separate power for motors via motor driver

  7. Cooling: Attach active cooler; monitor temps: vcgencmd measure_temp


For Arduino Uno + Motor Driver:

  1. Install Arduino IDE: Download from arduino.cc

  2. Connect via USB: Select board (Uno) and port in IDE

  3. Test Blink: Upload built-in "Blink" example to verify connection

  4. Wire Motor Driver: Connect IN1-IN4 to digital pins (e.g., 8, 9, 10, 11); ENA/ENB to PWM pins (5, 6); VCC to battery; Arduino 5V to motor driver's 5V output (if using 7-12V battery)

  5. Motor Library: Install AFMotor library (Sketch → Include Library → Manage Libraries)


For Jetson Orin Nano:

  1. Flash JetPack: Use NVIDIA SDK Manager or Jetson Orin Nano Developer Kit Guide

  2. Update: sudo apt update && sudo apt upgrade

  3. Install CUDA: Included in JetPack; verify with nvcc --version

  4. ROS 2 Install: Follow NVIDIA Isaac ROS or standard ROS 2 install

  5. Camera: Connect MIPI CSI or USB camera; test with nvgstcapture-1.0 (CSI) or cheese (USB)


Common Issues + Fixes

Raspberry Pi won't boot (red LED only):

  • Cause: Insufficient power or corrupted SD card

  • Fix: Use official 27W PSU; re-flash SD card with Raspberry Pi Imager; try different SD card


Arduino not recognized on USB:

  • Cause: Driver issue or wrong board selected

  • Fix: Install CH340 drivers (for clone boards); in IDE, ensure correct board (Tools → Board → Arduino Uno) and port (Tools → Port) selected


Motors running erratically with L298N:

  • Cause: Insufficient motor power supply or loose connections

  • Fix: Use separate battery for motors (not Arduino's 5V); check all GND connections are common; add 100μF capacitor across motor terminals to suppress noise


BNO055 sensor not detected (I2C):

  • Cause: Wrong address, loose wiring, or insufficient pullup resistors

  • Fix: Run I2C scan (i2cdetect -y 1 on Raspberry Pi; I2C Scanner sketch on Arduino); verify SDA/SCL connections; ensure 3.3V or 5V power matches sensor spec; add 4.7kΩ pullup resistors on SDA/SCL if needed


HC-SR04 returns inconsistent readings:

  • Cause: Poor power, EMI from motors, or soft target surfaces

  • Fix: Use separate clean 5V power; add decoupling capacitors (100μF) near sensor; avoid pointing at foam, cloth, or angled surfaces


Jetson Orin Nano overheating/throttling:

  • Cause: Sustained AI inference without cooling

  • Fix: Attach heatsink/fan (included in dev kit); monitor temps with tegrastats; reduce TDP if needed: sudo /usr/sbin/nvpmodel -m 1 (lower power mode)


Safety Notes & Compliance

Electrical Safety:

  • Voltage Limits: Never exceed GPIO voltage ratings (3.3V for Raspberry Pi, 5V for Arduino). Use level shifters or voltage dividers when interfacing 5V sensors with 3.3V systems.

  • Current Limits: Raspberry Pi GPIO outputs max 16mA per pin (50mA total across all pins). Do NOT drive LEDs, relays, or motors directly—use transistors or driver ICs.

  • Fuses: Add fuses (1-3A) on motor power lines to prevent overcurrent damage in case of shorts or stalls.


Mechanical Safety:

  • Rotating Parts: Spinning LiDAR modules and robot wheels can cause pinching or entanglement. Use emergency stop buttons on mobile robots.

  • Sharp Edges: LiDAR sensor housings and PCB edges can be sharp. Deburr or encase in protective mounts.


Standards & Regulations:

  • FCC Part 15 (USA): Development boards with WiFi/Bluetooth (Raspberry Pi, ESP32, UNO Q) carry FCC IDs for pre-compliance. If commercializing a robot, full FCC testing required.

  • CE Marking (EU): Similar to FCC; boards sold in EU must display CE mark. Check manufacturer compliance docs.

  • IEC 60950-1 (Replaced by IEC 62368-1): Safety of IT equipment; relevant if selling robotics kits commercially.

  • ISO 13849 (Safety of Machinery): For industrial robots or cobots, risk assessment and safety-rated controls required.


Battery Safety:

  • LiPo Batteries: Never overcharge, short-circuit, or puncture. Use LiPo-safe bags for charging; dispose of swollen batteries properly.

  • Voltage Regulators: Always use step-down regulators (buck converters) to supply stable 5V/3.3V to boards from higher-voltage batteries (e.g., 12V → 5V).


Data Privacy (for Camera/AI Robots):

  • GDPR (EU): Robots with cameras collecting personal data must comply with GDPR. Add visible indicators (LED) when camera is active.

  • CCPA (California): Similar privacy requirements for consumer robots sold in CA.


Glossary

  1. ADC (Analog-to-Digital Converter): Chip that converts analog sensor signals (voltage levels) into digital values readable by microcontrollers. Example: MPU6050 has a 16-bit ADC.


  2. BLE (Bluetooth Low Energy): Low-power wireless protocol for short-range communication, common in IoT sensors.


  3. Calibration: Process of adjusting sensor readings to remove offsets and drift. IMUs require calibration to account for manufacturing tolerances and magnetic interference.


  4. CUDA (Compute Unified Device Architecture): NVIDIA's parallel computing platform for GPU programming, essential for running neural networks on Jetson boards.


  5. DMP (Digital Motion Processor): On-chip co-processor in some IMUs (e.g., MPU6050) that can perform sensor fusion, though reverse-engineered firmware is needed to enable it.


  6. DOF (Degrees of Freedom): Number of independent motion parameters a sensor measures. 6-DOF = accel (3) + gyro (3); 9-DOF = accel (3) + gyro (3) + mag (3).


  7. Duty Cycle: In PWM, the percentage of time a signal is HIGH vs. LOW. 50% duty = half-speed motor.


  8. FOV (Field of View): Angular coverage of a sensor. LiDAR FOV: 360° horizontal = full circle; 59° vertical = up/down range.


  9. GPIO (General Purpose Input/Output): Programmable pins on SBCs/MCUs for reading sensors or controlling devices.


  10. H-Bridge: Circuit that allows reversing motor direction by switching polarity. "H" shape formed by 4 switches (transistors/MOSFETs).


  11. I2C (Inter-Integrated Circuit): Two-wire serial protocol (SDA/SCL) for connecting multiple sensors/devices to a microcontroller. Each device has a unique address (e.g., BNO055 = 0x28).


  12. IMU (Inertial Measurement Unit): Sensor combining accelerometer, gyroscope, and sometimes magnetometer to measure motion and orientation.


  13. LiDAR (Light Detection and Ranging): Sensor using laser pulses to measure distances and create 3D maps. Time-of-Flight (ToF) or FMCW techniques.


  14. MOSFET (Metal-Oxide-Semiconductor Field-Effect Transistor): Efficient electronic switch used in modern motor drivers (TB6612FNG). Lower voltage drop than bipolar transistors (L298N).


  15. PWM (Pulse Width Modulation): Technique to control motor speed or LED brightness by rapidly switching power ON/OFF at varying duty cycles.


  16. Quaternion: 4-number representation of 3D rotation (w, x, y, z), avoiding gimbal lock issues in Euler angles. BNO055 outputs quaternions directly.


  17. ROS (Robot Operating System): Open-source robotics middleware providing libraries, tools, and communication protocols for building robot software. ROS 2 is the latest version (2024-2025).


  18. SBC (Single-Board Computer): Computer with CPU, RAM, storage, and I/O on one board (e.g., Raspberry Pi). Runs full OS.


  19. Sensor Fusion: Combining data from multiple sensors (accel, gyro, mag) using algorithms (Kalman, Madgwick) to produce stable orientation estimates.


  20. SLAM (Simultaneous Localization and Mapping): Algorithm enabling robots to build maps of unknown environments while tracking their own location within those maps.


  21. STEMMA QT / Qwiic: Standardized 4-pin JST connectors for I2C sensors (Adafruit's STEMMA QT, SparkFun's Qwiic). Solderless plug-and-play.


  22. TOPS (Tera Operations Per Second): Measure of AI computing performance. Jetson Orin Nano: 40 TOPS = 40 trillion operations/sec.


  23. UART (Universal Asynchronous Receiver-Transmitter): Serial communication protocol (TX/RX pins) for device-to-device communication (e.g., Arduino ↔ GPS module).


  24. Voltage Divider: Two resistors in series that reduce voltage proportionally. Used to drop 5V signals to 3.3V for Raspberry Pi GPIO.


Sources (Annotated Bibliography)


Official Documentation

  1. Raspberry Pi Foundation — Official specifications and documentation for Raspberry Pi 5URL: https://www.raspberrypi.com/products/raspberry-pi-5/(Accessed October 15, 2025)

  2. NVIDIA Jetson Developer Zone — Jetson Orin Nano technical specs and JetPack SDKURL: https://developer.nvidia.com/embedded/jetson-orin-nano-developer-kit(Accessed October 15, 2025)

  3. Arduino Official Store — Arduino Uno R4 WiFi and UNO Q product pagesURL: https://store.arduino.cc(Accessed October 15, 2025)

  4. Livox Technology — Livox Mid-360 official specificationsURL: https://www.livoxtech.com/mid-360Published: Ongoing product page(Accessed October 15, 2025)

  5. Bosch Sensortec — BNO055 9-DOF IMU datasheetURL: https://www.bosch-sensortec.com/products/smart-sensors/bno055/(Accessed October 15, 2025)

  6. InvenSense (TDK) — MPU6050 6-DOF IMU datasheetURL: https://invensense.tdk.com/products/motion-tracking/6-axis/mpu-6050/(Accessed October 15, 2025)


Independent Testing & Reviews

  1. Electromaker.io — "Top Development Boards in 2025 for AI, Robotics and IoT"URL: https://www.electromaker.io/blog/article/the-best-development-boards-for-every-projectPublished: 2025(Accessed October 15, 2025)

  2. The IoT Academy — "Top 10 Embedded Development Boards for Robotics & Automation"Authors: The IoT Academy editorial teamURL: https://www.theiotacademy.co/blog/embedded-development-boards/Published: May 19, 2025(Accessed October 15, 2025)

  3. Very Technology — "Top IoT Boards for Development & Prototyping | 2025 Update"URL: https://www.verytechnology.com/insights/top-iot-boards-for-development-prototypingPublished: February 7, 2025(Accessed October 15, 2025)

  4. Hackster.io — "Best Edge AI Boards: Summer 2025 Edition"URL: https://www.hackster.io/news/best-edge-ai-boards-summer-2025-edition-cfe8581d7460Published: July 2025 (13 hours before access date)(Accessed October 15, 2025)

  5. Jaycon Systems — "Top 10 IoT Development Boards for Projects in 2025"URL: https://www.jaycon.com/top-10-iot-development-boards-for-projects-in-2025/Published: July 14, 2025(Accessed October 15, 2025)

  6. ThinkRobotics — "Top 5 AI boards to use in Robotics"URL: https://thinkrobotics.com/blogs/learn/top-5-ai-boards-to-use-in-roboticsPublished: September 17, 2024(Accessed October 15, 2025)


User Experiences & Case Studies

  1. RoboFoundry (Medium) — "Lessons learned while working with IMU Sensor, ROS2 and Raspberry Pi"Author: RoboFoundryURL: https://robofoundry.medium.com/lessons-learned-while-working-with-imu-sensor-ros2-and-raspberry-pi-a4fec18a7c7Published: April 3, 2022(Accessed October 15, 2025)

  2. Jeff Geerling — "Qualcomm's buying Arduino – what it means for makers"Author: Jeff GeerlingURL: https://www.jeffgeerling.com/blog/2025/qualcomms-buying-arduino-%E2%80%93-what-it-means-makersPublished: October 2025(Accessed October 15, 2025)

  3. Automatic Addison — "How to Publish IMU Data Using ROS and the BNO055 IMU Sensor"URL: https://automaticaddison.com/how-to-publish-imu-data-using-ros-and-the-bno055-imu-sensor/(Accessed October 15, 2025)

  4. Autominy GitHub Documentation — "Calibration: BNO055 and MPU6050"URL: https://autominy.github.io/AutoMiny/docs/calibration/Updated: July 4, 2025(Accessed October 15, 2025)


News & Market Data

  1. ZDNet / StartupNews.fyi — "What Qualcomm's Arduino deal means for Raspberry Pi"URL: https://startupnews.fyi/2025/10/14/what-qualcomms-arduino-deal-means-for-your-raspberry-pi/Published: October 14, 2025(Accessed October 15, 2025)

  2. The Register — "Qualcomm solders Arduino to its edge AI ambitions, debuts Raspberry Pi rival"URL: https://www.theregister.com/2025/10/07/qualcomm_arduino_acquisition/Published: October 7, 2025(Accessed October 15, 2025)

  3. Poe LiDAR — "LiDAR Pricing Across Different Applications in 2025: Key Trends and Insights"URL: https://www.poelidar.com/lidar-pricing-across-different-applications-in-2025-key-trends-and-insights/Published: April 16, 2025(Accessed October 15, 2025)

  4. IEEE Spectrum — "Sweep Is a $250 LIDAR With Range of 40 Meters That Works Outdoors"Author: Evan AckermanURL: https://spectrum.ieee.org/sweep-lidar-for-robots-and-dronesPublished: August 18, 2022(Accessed October 15, 2025)


Retailer & Technical Resources

  1. ProtoSupplies — "L298N Dual H-Bridge Motor Control Module"URL: https://protosupplies.com/product/l298n-dual-h-bridge-motor-control-module/Updated: November 27, 2024(Accessed October 15, 2025)

  2. Adafruit Industries — "Adafruit MPU-6050 6-DoF Accel and Gyro Sensor"URL: https://www.adafruit.com/product/3886(Accessed October 15, 2025)

  3. Adafruit Industries — "Adafruit 9-DOF Absolute Orientation IMU Fusion Breakout - BNO055"URL: https://www.adafruit.com/product/2472(Accessed October 15, 2025)

  4. SparkFun Electronics — "Ultrasonic Distance Sensor - 5V (HC-SR04)"URL: https://www.sparkfun.com/products/15569(Accessed October 15, 2025)

  5. RobotShop — "6 DOF Gyro, Accelerometer IMU - MPU6050"URL: https://www.robotshop.com/products/6-dof-gyro-accelerometer-imu-mpu6050(Accessed October 15, 2025)

  6. Robocraze — "Buy HC-SR04 Ultrasonic Sensor at Unbeatable Price"URL: https://robocraze.com/products/hc-sr-04-ultrasonic-sensor(Accessed October 15, 2025)

  7. Skynet Robotics — "HC-SR04-Ultrasonic Sensor"URL: https://www.skynetrobotics.in/products/hc-sr04-ultrasonic-sensor(Accessed October 15, 2025)

  8. ElectroPeak — "HC-SR04 Ultrasonic Distance Sensor Module"URL: https://electropeak.com/srf04-ultrasonic-sensor-module(Accessed October 15, 2025)

  9. RaspberryTips — "Raspberry Pi vs Arduino: 7 Differences you Should Know"URL: https://raspberrytips.com/raspberry-pi-vs-arduino/Updated: April 18, 2025(Accessed October 15, 2025)

  10. Electromaker.io — "The Best Single-Board Computer for Robotics"URL: https://www.electromaker.io/blog/article/best-single-board-computer-for-robotics(Accessed October 15, 2025)


Disclaimer: Prices and specifications are subject to change. Always verify current information with manufacturers and retailers before purchasing. This guide is for informational purposes only and does not constitute professional engineering advice. Follow all safety guidelines when working with electronics and robotics hardware.




$50

Product Title

Product Details goes here with the simple product description and more information can be seen by clicking the see more button. Product Details goes here with the simple product description and more information can be seen by clicking the see more button

$50

Product Title

Product Details goes here with the simple product description and more information can be seen by clicking the see more button. Product Details goes here with the simple product description and more information can be seen by clicking the see more button.

$50

Product Title

Product Details goes here with the simple product description and more information can be seen by clicking the see more button. Product Details goes here with the simple product description and more information can be seen by clicking the see more button.

Recommended Products For This Post
 
 
 

Comments


bottom of page