All Projects → tanyuan → braccio-ik-unity

tanyuan / braccio-ik-unity

Licence: MIT License
Braccio robotic arm simulator with IK (inverse kinematics) and controller via Serial in Unity.

Programming Languages

C#
18002 projects

Projects that are alternatives of or similar to braccio-ik-unity

RoboticsAcademy
Learn Robotics with JdeRobot
Stars: ✭ 160 (+220%)
Mutual labels:  robotics
trac ik
ROS 2 port of `trac_ik`, an alternative Inverse Kinematics solver to the popular inverse Jacobian methods in KDL.
Stars: ✭ 14 (-72%)
Mutual labels:  robotics
TORA.jl
Trajectory Optimization for Robot Arms
Stars: ✭ 27 (-46%)
Mutual labels:  robotics
graspnet-baseline
Baseline model for "GraspNet-1Billion: A Large-Scale Benchmark for General Object Grasping" (CVPR 2020)
Stars: ✭ 146 (+192%)
Mutual labels:  robotics
erwhi-hedgehog
Erwhi Hedgehog main repository
Stars: ✭ 31 (-38%)
Mutual labels:  robotics
MuJoCo RL UR5
A MuJoCo/Gym environment for robot control using Reinforcement Learning. The task of agents in this environment is pixel-wise prediction of grasp success chances.
Stars: ✭ 108 (+116%)
Mutual labels:  robotics
PnC
Planning and Control Algorithms for Robotics
Stars: ✭ 22 (-56%)
Mutual labels:  robotics
rapcores
Robotic Application Processor
Stars: ✭ 14 (-72%)
Mutual labels:  robotics
Tinymovr
Compact brushless motor controller with integrated absolute encoder and CAN Bus.
Stars: ✭ 90 (+80%)
Mutual labels:  robotics
bht-ams-playerstage
Player/Stage SLAM
Stars: ✭ 35 (-30%)
Mutual labels:  robotics
XBotControl
XBotControl framework: XBotCore + OpenSoT + CartesI/O
Stars: ✭ 23 (-54%)
Mutual labels:  robotics
robo-playground
Games and examples built for RoboMaster EP with RoboMasterPy | 与你的大疆机甲大师愉快玩耍,基于RoboMasterPy构建
Stars: ✭ 33 (-34%)
Mutual labels:  robotics
MeshCatMechanisms.jl
3D Visualization of mechanisms and URDFs using MeshCat.jl and RigidBodyDynamics.jl
Stars: ✭ 36 (-28%)
Mutual labels:  robotics
RustRobotics
Rust implementation of PythonRobotics such as EKF, DWA, Pure Pursuit, LQR.
Stars: ✭ 40 (-20%)
Mutual labels:  robotics
grasp multiObject
Robotic grasp dataset for multi-object multi-grasp evaluation with RGB-D data. This dataset is annotated using the same protocal as Cornell Dataset, and can be used as multi-object extension of Cornell Dataset.
Stars: ✭ 59 (+18%)
Mutual labels:  robotics
SLAM AND PATH PLANNING ALGORITHMS
This repository contains the solutions to all the exercises for the MOOC about SLAM and PATH-PLANNING algorithms given by professor Claus Brenner at Leibniz University. This repository also contains my personal notes, most of them in PDF format, and many vector graphics created by myself to illustrate the theoretical concepts. Hope you enjoy it! :)
Stars: ✭ 107 (+114%)
Mutual labels:  robotics
ROS-GPS
GPS Localization with ROS, OSM and rviz
Stars: ✭ 19 (-62%)
Mutual labels:  robotics
Drona
Drona is a programming framework for building safe robotics systems
Stars: ✭ 26 (-48%)
Mutual labels:  robotics
trajopt
Trajectory optimization algorithms for robotic control.
Stars: ✭ 74 (+48%)
Mutual labels:  robotics
brax
Massively parallel rigidbody physics simulation on accelerator hardware.
Stars: ✭ 1,208 (+2316%)
Mutual labels:  robotics

Arduino Tinkerkit Braccio IK For Unity

Braccio robotic arm simulator with IK (inverse kinematics) and controller via Serial in Unity.

Hardware

Arduino Tinkerkit Braccio

BraccioIKUnity

Unity Screenshot

Unity project developed with Unity 5.3.4.

  • Turn on Serial settings in Unity: Menu Edit > Project Settings > Player > Settings for PC ... Standalone Tab Other Settings > Api Compatibility Level > Choose .NET 2.0
  • Open scene Assets/Scenes/BraccioIK.unity
  • GameObject IKControl:
    • Transform: Move the Position to change robotic arm wrist IK target position.
    • Solve IK:
      • Toggle Use IK on to control the robotic arm with IK. (Theta Base, Theta Shoulder, Theta Elbow)
      • Toggle Auto End on to automatically turn the end pose horizontally. (Theta Wrist Vertical)
    • Arduino Serial: Send motor angles every 5 seconds (Delay Seconds) to Serial. Change Port Name before use. Default off.
    • Gizmo: Visualize target position.

BraccioSerialArduino

Arduino counterpart code which receives commands from Unity. Need to have Braccio library installed.

Authors

BraccioIK.unity / SolveIK.cs: Shan-Yuan Teng [email protected]
BraccioSerialArduino.ino: Yung-Ta Lin

License

MIT

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