pangineering's Stars
borglab/gtsam
GTSAM is a library of C++ classes that implement smoothing and mapping (SAM) in robotics and vision, using factor graphs and Bayes networks as the underlying computing paradigm rather than sparse matrices.
mit-acl/cadrl_ros
ROS package for dynamic obstacle avoidance for ground robots trained with deep RL
giacomo-b/CppRobotics
Header-only C++ library for robotics, control, and path planning algorithms. Work in progress, contributions are welcome!
Le0nX/ModernRoboticsCpp
Modern Robotics: Mechanics, Planning, and Control C++ Library --- The primary purpose of the provided software is to be easy to read and educational, reinforcing the concepts in the book. The code is optimized neither for efficiency nor robustness. http://modernrobotics.org/
udacity/RL-Quadcopter
Teach a Quadcopter How to Fly!
Forrest-Z/cpp_robotics
C++ sample codes for robotics algorithms.
srmauvsoftware/URSim
Simulator for Unmanned Underwater Vehicles using ROS and Unity3D
pgigioli/darknet_ros
YOLO integration with ROS for real-time object detection
yiyunevin/RL-RRT-Local-Planner
A ROS package of a autonomous navigation method based on SAC and Bidirectional RRT* (Repository RL-RRT-Global-Planner).
sskorol/ros2-humble-docker-dev-template
This repo provides a template for a quick start with a ROS2 Humble development in Docker
navidsafaeian/Deep-Reinforcement-Learning-Arm-Manipulation-Project-using-DQN-Agent
Robotics-Deep Reinforcement Learning Project: Deep RL Arm Manipulation by using DQN (Deep Q-Learning Network) agent simulated on ROS-Gazebo with C++ API.
PacktPublishing/Hands-On-Robotics-Programming-with-Cpp
Hands-On Robotics Programming with C++, published by Packt
org-arl/UWRoboticsSimulator
A Unity3d - ROS based Underwater Simulator
lbrombach/practical_robot
Several ROS packages for a differential drive robot - code that accompanies the book Practical Roboics in C++
srv/auv_framework
ROS stack for control and navigation of autonomous underwater vehicles
mcx-lab/ros_pybullet_rl2
Integration of ROS, Pybullet, and OpenAI Gym RL Framework
eselkin/Swarmathon-ROS
ROS control libraries, 3D models, and scripts for NASA Swarmathon robots
kavyadevd/AcmeRoboticsPathPlanner
A C++ based manipulator arm path planner with IK solver and output simulator
AlessandroRuzzi/Robotics-Projects
:robot: Projects realized using ROS and C++, developed for the Robotics course project
ggsharma/droneRL
Reinforcement learning based ROS repository
hubery05/Robotic-Books
BOOKS: Python, ROS, path planning, C++
kakashihatakae/Autonomous-Underwater-Vehicle-codes
This repository contains all the codes that I have written in ROS using C++ and python for our Autonomous Underwarer Vehicle project in my undergrad
ptiwari0664/RoboticsSoftwareEngineer
Begin your exploration into the world of robotics software engineering with a practical, system-focused approach to programming robots using the ROS framework and C++. In addition, learn and apply robotics software engineering algorithms such as localization, mapping, and navigation.
Karthik180304/ROS2_Hexapod_Robot
Building a six legged robot which obeys line following functionality according to the line's color
youssefattia98/ROS-based-Autonomous-Wall-Avoidance-Robot
Leveraging ROS and C++ to develop a robot capable of navigating without colliding with walls. It showcases sensor feedback handling, decision-making algorithms, and user-interaction for speed control, providing a comprehensive simulation of autonomous movement.
arushikhokhar/Monopod-Robot
A single-legged hopping robot simulation created using ROS and Gazebo
jacketfffff/Wheel_legged_robot
This package is for an multi-joint robot and accomplishes the planning and control based on ros
jgmatu/Robotica
C++ Robotics with ROS.
NURobotics/rov_control
ROS package to control ROV underwater from driving station
WhyWouldYouTilt/Rosbot_DeepRL_Autonomous
Deep RL for autonomous driving with Rosbot