All Projects → DanIsraelMalta → Helicopter-Simulation

DanIsraelMalta / Helicopter-Simulation

Licence: MIT license
A complete 6DOF helicopter simulation (physics engine + visualization)

Programming Languages

c
50402 projects - #5 most used programming language

Projects that are alternatives of or similar to Helicopter-Simulation

Robotics-Planning-Dynamics-and-Control
RPDC : This contains all my MATLAB codes for the Robotics, Planning, Dynamics and Control . The implementations model various kinds of manipulators and mobile robots for position control, trajectory planning and path planning problems.
Stars: ✭ 171 (+280%)
Mutual labels:  kinematics, dynamics
Rigidbodydynamics.jl
Julia implementation of various rigid body dynamics and kinematics algorithms
Stars: ✭ 184 (+308.89%)
Mutual labels:  kinematics, dynamics
biomechanics dataset
Information of public available data sets for biomechanics.
Stars: ✭ 31 (-31.11%)
Mutual labels:  kinematics, dynamics
Robotics Toolbox Matlab
Robotics Toolbox for MATLAB
Stars: ✭ 601 (+1235.56%)
Mutual labels:  kinematics, dynamics
Pinocchio
A fast and flexible implementation of Rigid Body Dynamics algorithms and their analytical derivatives
Stars: ✭ 432 (+860%)
Mutual labels:  kinematics, dynamics
Robotics Toolbox Python
Robotics Toolbox for Python
Stars: ✭ 369 (+720%)
Mutual labels:  kinematics, dynamics
wb-toolbox
Simulink toolbox to rapidly prototype robot controllers
Stars: ✭ 20 (-55.56%)
Mutual labels:  kinematics, dynamics
Rl
The Robotics Library (RL) is a self-contained C++ library for rigid body kinematics and dynamics, motion planning, and control.
Stars: ✭ 391 (+768.89%)
Mutual labels:  kinematics, dynamics
Dart
Dynamic Animation and Robotics Toolkit
Stars: ✭ 596 (+1224.44%)
Mutual labels:  kinematics, dynamics
Pybotics
The Python Toolbox for Robotics
Stars: ✭ 192 (+326.67%)
Mutual labels:  kinematics, dynamics
Ikbt
A python package to solve robot arm inverse kinematics in symbolic form
Stars: ✭ 97 (+115.56%)
Mutual labels:  kinematics
Makelangelo Firmware
CNC firmware for many different control boards and kinematic systems. Originally the brain of the Makelangelo art robot.
Stars: ✭ 116 (+157.78%)
Mutual labels:  kinematics
generator-nullfactory-xrm
Yeoman generator for Dynamics 365 Solutions. It generates a project structure that facilitates the quick creation builds and automated release strategies with minimal effort.
Stars: ✭ 15 (-66.67%)
Mutual labels:  dynamics
bpsci
6DOF Dynamic Simulations for Blender with Python
Stars: ✭ 26 (-42.22%)
Mutual labels:  dynamics
Wave geometry
Manifold geometry with fast automatic derivatives and coordinate frame semantics checking
Stars: ✭ 92 (+104.44%)
Mutual labels:  kinematics
PINN-elastodynamics
physics-informed neural network for elastodynamics problem
Stars: ✭ 68 (+51.11%)
Mutual labels:  physics-simulation
K
k: Kinematics Library for rust-lang
Stars: ✭ 66 (+46.67%)
Mutual labels:  kinematics
RobotArmHelix
3D Simulation, forward and inverse kinematics of a robotic arm in C# using WPF and helix-toolkit
Stars: ✭ 84 (+86.67%)
Mutual labels:  kinematics
BowlerStudio
A Full-Stack Robotics Development Environment
Stars: ✭ 95 (+111.11%)
Mutual labels:  physics-simulation
Bullet3
Bullet Physics SDK: real-time collision detection and multi-physics simulation for VR, games, visual effects, robotics, machine learning etc.
Stars: ✭ 8,714 (+19264.44%)
Mutual labels:  kinematics

Helicopter-Simulation

Codacy Badge

A complete rigid body six degrees of freedom helicopter simulation (ANSI-C) including:

  • Main rotor model (including a linear rotor flapping model accounting for coupled servo rotor dynamics and mechanical feedback by the gyroscopic effect of the stabilizer bar, e.g. - fly-bar)
  • Both main & tail rotor include a combined finite element and blade momentum theory model for the calculation of a rotor thrust, power and torque
  • Vertical & horizontal stabilizer simulation (full aerodynamics)
  • ground contact/collision simulation
  • Opengl based "outside world" and "inertial navigation system" windows
  • Second order (non linear) servo model
  • WGS-84 gravity model
  • Dryden (linearized) wind model
  • Standard atmosphere model (ISA)
  • Equations of motion integration using 4th order Runge-Kuta
  • IMU emulator
  • A place to write the flight control code...

Alt text

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].