All Projects → JuliaRobotics → MeshCatMechanisms.jl

JuliaRobotics / MeshCatMechanisms.jl

Licence: other
3D Visualization of mechanisms and URDFs using MeshCat.jl and RigidBodyDynamics.jl

Programming Languages

julia
2034 projects

Projects that are alternatives of or similar to MeshCatMechanisms.jl

FloBaRoID
Framework for dynamical system identification of floating-base rigid body tree structures
Stars: ✭ 53 (+47.22%)
Mutual labels:  robotics, urdf
kinpy
Simple kinematics calculation toolkit for robotics
Stars: ✭ 48 (+33.33%)
Mutual labels:  robotics, urdf
awesome-photogrammetry
😎 Awesome photogrammetry projects
Stars: ✭ 199 (+452.78%)
Mutual labels:  robotics
erwhi-hedgehog
Erwhi Hedgehog main repository
Stars: ✭ 31 (-13.89%)
Mutual labels:  robotics
RoboticsAcademy
Learn Robotics with JdeRobot
Stars: ✭ 160 (+344.44%)
Mutual labels:  robotics
UDTStudio
UniSwarm Tools for UDT interface and CANOpen in Qt5
Stars: ✭ 13 (-63.89%)
Mutual labels:  robotics
graspnet-baseline
Baseline model for "GraspNet-1Billion: A Large-Scale Benchmark for General Object Grasping" (CVPR 2020)
Stars: ✭ 146 (+305.56%)
Mutual labels:  robotics
2019-UGRP-DPoom
2019 DGIST DPoom project under UGRP : SBC and RGB-D camera based full autonomous driving system for mobile robot with indoor SLAM
Stars: ✭ 35 (-2.78%)
Mutual labels:  robotics
ROS-GPS
GPS Localization with ROS, OSM and rviz
Stars: ✭ 19 (-47.22%)
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 (+197.22%)
Mutual labels:  robotics
robo-playground
Games and examples built for RoboMaster EP with RoboMasterPy | 与你的大疆机甲大师愉快玩耍,基于RoboMasterPy构建
Stars: ✭ 33 (-8.33%)
Mutual labels:  robotics
PnC
Planning and Control Algorithms for Robotics
Stars: ✭ 22 (-38.89%)
Mutual labels:  robotics
academy
🎓 Video tutorials, slide decks and other training materials for developers learning about the FIWARE ecosystem.
Stars: ✭ 12 (-66.67%)
Mutual labels:  robotics
XBotControl
XBotControl framework: XBotCore + OpenSoT + CartesI/O
Stars: ✭ 23 (-36.11%)
Mutual labels:  robotics
aruw-vision-platform-2019
ARUW's vision code from the 2019 season. Published here, read-only, for public reference.
Stars: ✭ 37 (+2.78%)
Mutual labels:  robotics
Tinymovr
Compact brushless motor controller with integrated absolute encoder and CAN Bus.
Stars: ✭ 90 (+150%)
Mutual labels:  robotics
jiminy
Jiminy: a fast and portable Python/C++ simulator of poly-articulated systems with OpenAI Gym interface for reinforcement learning
Stars: ✭ 90 (+150%)
Mutual labels:  robotics
AI-Lab
🔬 Absolutely comfort lab for me to work around with my own AIs and to empirically observe how powerful and impactful these technologies are. I do love these technologies!
Stars: ✭ 19 (-47.22%)
Mutual labels:  robotics
RustRobotics
Rust implementation of PythonRobotics such as EKF, DWA, Pure Pursuit, LQR.
Stars: ✭ 40 (+11.11%)
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 (+200%)
Mutual labels:  robotics

MeshCatMechanisms

Build Status codecov.io

MeshCatMechanisms.jl adds support for visualizing mechanisms and robots from RigidBodyDynamics.jl with MeshCat.jl. All geometries are constructed using MechanismGeometries.jl.

Features:

  • Parsing geometry directly from URDF files
  • Animation of robot trajectories from RigidBodyDynamics.jl simulations
  • Live rendering of simulation progress using the OdeIntegrators.OdeResultsSink interface
  • Interactive manipulation of the mechanism configuration using InteractBase.jl

Related Projects

MeshCatMechanisms.jl provides similar functionality to RigidBodyTreeInspector.jl, but is built on top of the lighter-weight MeshCat viewer instead of DrakeVisualizer.jl.

Installation

Stable release:

Pkg.add("MeshCatMechanisms")

Latest and greatest:

Pkg.add("MeshCatMechanisms")
Pkg.clone("https://github.com/rdeits/MechanismGeometries.jl")
Pkg.checkout("MeshCatMechanisms")
Pkg.checkout("MeshCat")

Usage

See examples/demo.ipynb

Examples

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