Topic: "differential-drive-robot"
ros-mobile-robots/diffbot
DiffBot is an autonomous 2wd differential drive robot using ROS Noetic on a Raspberry Pi 4 B. With its SLAMTEC Lidar and the ROS Control hardware interface it's capable of navigating in an environment using the ROS Navigation stack and making use of SLAM algorithms to create maps of unknown environments.
Language: C++ - Size: 8.06 MB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 263 - Forks: 80

Ekumen-OS/andino
Open-source diff drive robot ROS 2 compatible
Language: C++ - Size: 13.7 MB - Last synced at: 12 days ago - Pushed at: 3 months ago - Stars: 227 - Forks: 57

TheNoobInventor/lidarbot
A differential drive robot is controlled using ROS2 Humble running on a Raspberry Pi 4 (running Ubuntu server 22.04). The vehicle is equipped with a raspberry pi camera for visual feedback and an RPlidar A1 sensor used for Simultaneous Localization and Mapping (SLAM), autonomous navigation and obstacle avoidance.
Language: Python - Size: 84 MB - Last synced at: 4 days ago - Pushed at: 4 days ago - Stars: 141 - Forks: 30

botprof/agv-examples
A repository of introductory autonomous ground vehicle (i.e., wheeled mobile robot) simulation examples in Python.
Language: Python - Size: 165 KB - Last synced at: 25 days ago - Pushed at: 5 months ago - Stars: 60 - Forks: 20

Reinbert/ros_esp32cam_diffdrive
This is a ROS 2 & Micro-ROS project to control an RC tank with differential drive (skid steering) with an ESP32-CAM module.
Language: C - Size: 18.6 KB - Last synced at: over 1 year ago - Pushed at: almost 2 years ago - Stars: 39 - Forks: 9

zainkhan-afk/Differential-Drive-Robot-Navigation
A path following differential drive robot controlled using a PID controller and Model Predictive Controller (MPC)
Language: Python - Size: 9.82 MB - Last synced at: 7 months ago - Pushed at: 7 months ago - Stars: 33 - Forks: 8

rayvburn/diff_drive_mapping_robot
ROS driver for the Raspberry Pi based differential drive robot
Language: C++ - Size: 26.9 MB - Last synced at: over 1 year ago - Pushed at: over 6 years ago - Stars: 26 - Forks: 10

ngzhili/Two-Wheel-Robot-DeepRL
Balancing, Moving, and Traversing Slopes with a Two-Wheel Robot using Deep Reinforcement Learning
Language: Python - Size: 70.4 MB - Last synced at: about 2 months ago - Pushed at: about 2 months ago - Stars: 18 - Forks: 4

saptadeb/botLab
Project for ROB 550. Implementing SLAM using LIDAR, wheel encoders and IMU on MBot.
Language: C - Size: 12 MB - Last synced at: 10 months ago - Pushed at: over 3 years ago - Stars: 16 - Forks: 4

gmeidk/DelyBot
DelyBot is a robot that uses six wheels to drive itself along pedestrian paths but also on public roads to reach requested delivery addresses.
Language: CMake - Size: 2.86 MB - Last synced at: about 2 years ago - Pushed at: over 2 years ago - Stars: 9 - Forks: 4

PedroS235/perceptron_bot
Perceptron Bot: A differential drive robot
Size: 62.4 MB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 8 - Forks: 1

Weizhe-Chen/tracking_pid
A simple controller tracking x, y, and yaw
Language: C++ - Size: 2.24 MB - Last synced at: almost 2 years ago - Pushed at: almost 2 years ago - Stars: 8 - Forks: 2

pal-robotics/pmb2_simulation
Language: Python - Size: 12.8 MB - Last synced at: 25 days ago - Pushed at: 25 days ago - Stars: 6 - Forks: 3

bekirbostanci/dolly-foxy
ros2 differential drive robot
Language: Python - Size: 33.4 MB - Last synced at: about 2 years ago - Pushed at: over 4 years ago - Stars: 5 - Forks: 0

RickyMexx/ls-slam-2d
Least Squares optimization of a 2D -Range Only- SLAM problem.
Language: MATLAB - Size: 235 KB - Last synced at: about 2 years ago - Pushed at: about 4 years ago - Stars: 4 - Forks: 0

nerellasureshkumar7/differential_drive_robot
This package contains the description of differential_drvie robot in Gazebo.
Language: CMake - Size: 538 KB - Last synced at: about 1 year ago - Pushed at: over 5 years ago - Stars: 4 - Forks: 1

DimitrisKatos/my_robot
Two wheel robot with camera, lidar and differential drive.
Language: Python - Size: 712 KB - Last synced at: 29 days ago - Pushed at: over 1 year ago - Stars: 3 - Forks: 0

silvery107/silvery-botlab-f22
Botlab for ROB 550 @ UMich Robotics
Language: C - Size: 7.13 MB - Last synced at: about 1 year ago - Pushed at: over 1 year ago - Stars: 3 - Forks: 1

hcdiekmann/pathfinder
A differential wheeled robot simulation with ROS 2 and Gazebo Classic
Language: Python - Size: 706 KB - Last synced at: about 2 years ago - Pushed at: about 2 years ago - Stars: 3 - Forks: 0

Francis-Bui/LegoSwerve
Repository for a differential swerve robot using limited Lego electronics
Language: C - Size: 85.9 KB - Last synced at: almost 2 years ago - Pushed at: over 2 years ago - Stars: 3 - Forks: 0

lambertinialessandro/AMR-FinalProject Fork of glofru/AMR-FinalProject
Grid-based path planning for a differential drive robot
Language: MATLAB - Size: 9.43 MB - Last synced at: about 2 years ago - Pushed at: almost 3 years ago - Stars: 3 - Forks: 0

ros-mobile-robots/ros-mobile-robots.github.io
Website and documentation for the ros-mobile-robots organization.
Size: 142 MB - Last synced at: 8 months ago - Pushed at: 8 months ago - Stars: 2 - Forks: 4

PrwTsrt/microros_esp32_diffdrive
A ROS 2 and micro-ROS project controlling a differential drive robot with a Yahboom ESP32-S3 board, using Ubuntu 22.04 and ROS 2 Humble on an Orange Pi 5B. The ESP32 is connected via USB/UART.
Language: C - Size: 32.1 MB - Last synced at: 9 months ago - Pushed at: 9 months ago - Stars: 2 - Forks: 0

mkner/robo-pid
RoboPID is a PID controller designed for Autonomous Mobile Robotics to handle the combined kinematic and dynamic complexity of differential drive linear and lateral wheeled motion control. The controller implements timestep integration and can be used in discretized time regulators.
Language: Python - Size: 368 KB - Last synced at: 25 days ago - Pushed at: 12 months ago - Stars: 2 - Forks: 0

MaxMSun/Joey
Joey: Customizable ROS Joystick Driver for Differential-Drive Robots
Language: C++ - Size: 18.6 KB - Last synced at: 3 months ago - Pushed at: over 3 years ago - Stars: 2 - Forks: 0

YJ0528/minibot
ROS2 Jazzy diffferential drive robot with teleoperation, SLAM and NAV2
Language: Python - Size: 13 MB - Last synced at: 6 months ago - Pushed at: 6 months ago - Stars: 1 - Forks: 1

EnriqManComp/differential-drive-robot-model-ros-gazebo
In this project, a model of a differential drive robot (DDR) was designed for use with ROS and Gazebo. The model includes lidar and collision sensors. Additionally, three nodes were coded to obtain laser data and control the movement of the robot.
Language: Python - Size: 313 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 1 - Forks: 0

PedroS235/motor_controller
An Arduino based motor controller for a differential drive robot
Language: C++ - Size: 423 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 1 - Forks: 0

FTCTeam11531/TechnoTrojanTraining_Drivetrain_Differential
Techno Trojan Training Series - Drivetrain - Differential
Language: Java - Size: 475 KB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 1 - Forks: 0

abdalla1912mohamed/ackerman-vehicle-steering-mecha--nism-was-implemented-on-autonomous-vehicle.
an ackerman vehicle steering mecha- nism was implemented on autonomous vehicle. Simulation using ROS Melodic and Gazebo was carried out to develop multiple nodes for speed and lateral control of the vehicle, and also for the localization problem using Kalman Filter to clear the noise. The Hardware was implemented using ROS enabled Raspberry Pi 4 and 2 Arduinos for Measurement and Control Purpose. Gyroscope and Optical Encoders were used as the sensory elements. The robot was tested by tracking a specific path in mulitple maps
Language: Python - Size: 2.18 MB - Last synced at: over 1 year ago - Pushed at: over 2 years ago - Stars: 1 - Forks: 0

quantumxt/ros-pibot 📦
A simple 2 wheel robot powered by ROS, Arduino & Raspberry Pi 3.
Language: C++ - Size: 5.86 KB - Last synced at: about 2 years ago - Pushed at: almost 4 years ago - Stars: 1 - Forks: 4

abhinayh56/DDR
This is the repository of differential drive robot.
Language: C++ - Size: 3.91 KB - Last synced at: about 2 years ago - Pushed at: over 6 years ago - Stars: 1 - Forks: 0

Frata-Robotics/small-ugv-non-ros
Arduino sketch for Frata Robotic's small UGV (non-ROS).
Language: C++ - Size: 0 Bytes - Last synced at: 3 months ago - Pushed at: 3 months ago - Stars: 0 - Forks: 0

RedDuckBot/Mobile-Turret-Robot
Mobile turret robot equipped with a 1DOF turret that shoots foam balls.
Language: C++ - Size: 55 MB - Last synced at: about 1 month ago - Pushed at: 3 months ago - Stars: 0 - Forks: 0

migit/Yolu
Yolu is a companion robot based on A2R3 platform with personality
Language: C++ - Size: 7.81 KB - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 0 - Forks: 0

anurye/Mobile-Robot-Navigation-Using-Deep-Reinforcement-Learning-and-ROS
Deep Reinforcement Learning Based Mobile Robot Navigation Using ROS2 and Gazebo
Language: Python - Size: 228 MB - Last synced at: 6 months ago - Pushed at: 6 months ago - Stars: 0 - Forks: 0

Ellakiya15/bot_ws
This repo contains simple workspace of ros2 that controls a differential drive robot.
Language: HTML - Size: 40 MB - Last synced at: 7 months ago - Pushed at: 7 months ago - Stars: 0 - Forks: 0

vstoneofficial/megarover3_ros2
メガローバーVer.3.0 ROS 2 パッケージ
Language: Python - Size: 892 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 1

farhan-haroon/Autonomous-Navigation-using-Wheel-Odometry
This repository is the implementation of A-Star path planning algorithm on the 2-D matrix. It is implemented on a ROBOTIS Turtle Bot 3 and is usable by any differential drive robot using ROS NOETIC. This project is developed by Mohd Farhan Haroon, at the Integral Robotics Lab, Integral University, Lucknow. Contact me at [email protected]
Language: Python - Size: 11.1 MB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

geeksahil53/ROS-Navigation-Stack-for-Two-Wheeled-Bot
ROS navigation stack for a two-wheeled robot, enabling autonomous navigation using SLAM techniques
Language: CMake - Size: 44.9 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

frmadeira/nmpc_controller
NMPC controller for trajectory tracking and obstacle avoidance
Language: Python - Size: 14.6 KB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 0

GeoKrom/UoI-Robotics-course
Trajectory planning of p2os robot using ROS environment and Gazebo simulator
Language: Makefile - Size: 912 KB - Last synced at: almost 2 years ago - Pushed at: almost 2 years ago - Stars: 0 - Forks: 0

bubbarello/Robotics-Project
This project simulates an autonomous robot (Differential Drive) that has to avoid certain obstacles to reach a defined goal from a starting point
Language: MATLAB - Size: 34.2 KB - Last synced at: almost 2 years ago - Pushed at: almost 2 years ago - Stars: 0 - Forks: 0

Walid-khaled/autonomous_mobile_robots
This repository contains different aspects of autonomous mobile robots including motion, control, and estimation. PID, LQR, and MPC controllers for differential drive robot are developed with ROS2. In addition, some filters are covered such as particle filter and ekf for localization.
Language: Jupyter Notebook - Size: 205 MB - Last synced at: about 2 years ago - Pushed at: about 2 years ago - Stars: 0 - Forks: 1

yashsriram/wall-e
A neural-network controller for a differential-drive agent to reach a goal.
Language: Rust - Size: 526 KB - Last synced at: about 2 years ago - Pushed at: over 2 years ago - Stars: 0 - Forks: 0

darkhorrow/sim-diff-rob
A differential simulation in Matlab of a basic 'robot' performing some routes.
Language: MATLAB - Size: 3.91 KB - Last synced at: about 2 years ago - Pushed at: about 4 years ago - Stars: 0 - Forks: 0

Pruthvi-Sanghavi/air_water_land_surveillance_bot
Repository for air water and land surveillance robot developed as a part of DRDO Robotics and Unmanned Systems Exposition.
Size: 3.19 MB - Last synced at: almost 2 years ago - Pushed at: about 4 years ago - Stars: 0 - Forks: 0

ctsaitsao/arm-move-diff-drive
InterbotiX MoveIt motion planning + Gazebo diff drive tasks.
Language: Python - Size: 38.1 KB - Last synced at: about 2 years ago - Pushed at: over 4 years ago - Stars: 0 - Forks: 0

Marslanali/two-wheel-robot-gazebo 📦
two wheel differential drive robot simulation in gazebo
Language: C++ - Size: 961 KB - Last synced at: almost 2 years ago - Pushed at: about 5 years ago - Stars: 0 - Forks: 2

anandvgeorge/irobot
This repo is a ROS workspace for a differential drive robot project. In this project I try to implement the control of the robot mentioned in the course, Control of Mobile Robots by Georgia Tech on Coursera. The robot is very basic one and different from the QuickBot mentioned in the course.
Language: C++ - Size: 62.5 KB - Last synced at: about 1 year ago - Pushed at: over 5 years ago - Stars: 0 - Forks: 0

nerellasureshkumar7/differential_drive_navigation
This package contains the Navigation for Differential_drive robot
Language: CMake - Size: 2.1 MB - Last synced at: about 1 year ago - Pushed at: over 5 years ago - Stars: 0 - Forks: 0

sudarshan-s-harithas/Design-of-Differential-Drive-Robot-
The Design of the Differential Drive Robot has been explained in detail and the mathematical equations for the kinematics has been derived
Size: 253 KB - Last synced at: about 2 years ago - Pushed at: almost 6 years ago - Stars: 0 - Forks: 0

bessszilard/RTT_G
The Autonomous Sign Detector and Object Tracker Robot
Language: C++ - Size: 6.68 MB - Last synced at: about 1 year ago - Pushed at: about 6 years ago - Stars: 0 - Forks: 0

ehoxha91/DifferentialDriveUnity
Implementation of differential of a mobile robot using Unity3D
Language: C# - Size: 100 MB - Last synced at: about 2 years ago - Pushed at: about 6 years ago - Stars: 0 - Forks: 0
