All Projects → KumarRobotics → kr_mav_control

KumarRobotics / kr_mav_control

Licence: BSD-3-Clause license
Code for quadrotor control

Programming Languages

C++
36643 projects - #6 most used programming language
python
139335 projects - #7 most used programming language
CMake
9771 projects
matlab
3953 projects

Projects that are alternatives of or similar to kr mav control

QuadrotorFly
This is a dynamic simulation for quadrotor UAV
Stars: ✭ 61 (+96.77%)
Mutual labels:  control, simulation, quadrotor
Deepdrive
Deepdrive is a simulator that allows anyone with a PC to push the state-of-the-art in self-driving
Stars: ✭ 628 (+1925.81%)
Mutual labels:  control, simulation
Spot mini mini
Dynamics and Domain Randomized Gait Modulation with Bezier Curves for Sim-to-Real Legged Locomotion.
Stars: ✭ 426 (+1274.19%)
Mutual labels:  control, ros
Mrs uav system
The entry point to the MRS UAV system.
Stars: ✭ 64 (+106.45%)
Mutual labels:  control, ros
Visual Gps Slam
This is a repo for my master thesis research about the Fusion of Visual SLAM and GPS. It contains the research paper, code and other interesting data.
Stars: ✭ 175 (+464.52%)
Mutual labels:  simulation, ros
Free gait
An Architecture for the Versatile Control of Legged Robots
Stars: ✭ 263 (+748.39%)
Mutual labels:  control, ros
Missionplanner
Mission Planner Ground Control Station (c# .net)
Stars: ✭ 1,059 (+3316.13%)
Mutual labels:  control, ros
Autonomous Drone
This repository intends to enable autonomous drone delivery with the Intel Aero RTF drone and PX4 autopilot. The code can be executed both on the real drone or simulated on a PC using Gazebo. Its core is a robot operating system (ROS) node, which communicates with the PX4 autopilot through mavros. It uses SVO 2.0 for visual odometry, WhyCon for visual marker localization and Ewok for trajectoy planning with collision avoidance.
Stars: ✭ 87 (+180.65%)
Mutual labels:  simulation, ros
Mesh navigation
ROS Mesh Navigation Bundle
Stars: ✭ 114 (+267.74%)
Mutual labels:  control, ros
Mav control rw
Control strategies for rotary wing Micro Aerial Vehicles using ROS
Stars: ✭ 154 (+396.77%)
Mutual labels:  control, ros
Rigidbodydynamics.jl
Julia implementation of various rigid body dynamics and kinematics algorithms
Stars: ✭ 184 (+493.55%)
Mutual labels:  control, simulation
Mpc ros
Nonlinear Model Predictive Control on Differential Wheeled Mobile Robot using ROS
Stars: ✭ 140 (+351.61%)
Mutual labels:  simulation, ros
Aws Robomaker Sample Application Deepracer
Use AWS RoboMaker and demonstrate running a simulation which trains a reinforcement learning (RL) model to drive a car around a track
Stars: ✭ 105 (+238.71%)
Mutual labels:  simulation, ros
Webots
Webots Robot Simulator
Stars: ✭ 1,324 (+4170.97%)
Mutual labels:  simulation, ros
the-Cooper-Mapper
An open source autonomous driving research platform for Active SLAM & Multisensor Data Fusion
Stars: ✭ 38 (+22.58%)
Mutual labels:  control, ros
Bebops
BebopS aims to simulate the behavior of Parrot Bebop 2 by using SIL methodologies
Stars: ✭ 40 (+29.03%)
Mutual labels:  control, ros
Mrsl quadrotor
Stars: ✭ 56 (+80.65%)
Mutual labels:  simulation, ros
Robots
Collection of quadrupedal robots configured to work in CHAMP development framework
Stars: ✭ 59 (+90.32%)
Mutual labels:  simulation, ros
Grl
Robotics tools in C++11. Implements soft real time arm drivers for Kuka LBR iiwa plus V-REP, ROS, Constrained Optimization based planning, Hand Eye Calibration and Inverse Kinematics integration.
Stars: ✭ 105 (+238.71%)
Mutual labels:  control, ros
safe-control-gym
PyBullet CartPole and Quadrotor environments—with CasADi symbolic a priori dynamics—for learning-based control and RL
Stars: ✭ 272 (+777.42%)
Mutual labels:  control, quadrotor

kr_mav_control

ROS packages for quadrotor control

Build Status

Stack includes:

  • kr_mav_manager: A manager for the kr_mav_control stack
  • rqt_mav_manager: GUI interface for common kr_mav_manager functions
  • interfaces: Translates kr_mav_msgs/SO3Command to corresponding robots interface.
  • kr_quadrotor_simulator: Simple quadrotor dynamics simulator
  • kr_mav_msgs: Common msgs used across packages
  • kr_mav_controllers: Position controllers
  • trackers: Different trackers under kr_trackers, and kr_trackers_manager

Example use cases:

The multi robot examples uses following packages.

Running single robot with the included simple simulator

Running multiple robots with the included simple simulator

MATLAB interface with simple simulator

Python interface with simple simulator

Running with Gazebo

Running multiple robots with Gazebo

Block Diagram

The following block diagram shows how the packages in the repo fit together. Block Diagram

Further detailed breakdown of the blocks can be found in the PPT

Note that the project description data, including the texts, logos, images, and/or trademarks, for each open source project belongs to its rightful owner. If you wish to add or remove any projects, please contact us at [email protected].