This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
# Update CMakeLists in ~/catkin_ws/src/unitree_ros/unitree_controller | |
catkin_install_python(PROGRAMS scripts/joint_mover.py | |
DESTINATION ${CATKIN_PACKAGE_BIN_DESTINATION} | |
) | |
#!/usr/bin/env python | |
import rospy | |
from sensor_msgs.msg import JointState | |
from std_msgs.msg import Header |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
docker run -p 6080:80 --shm-size=512m --name ros_go1 -d tiryoh/ros-desktop-vnc:melodic | |
sudo sh -c 'echo "deb http://packages.ros.org/ros/ubuntu $(lsb_release -sc) main" > /etc/apt/sources.list.d/ros-latest.list' | |
curl -s https://raw.githubusercontent.com/ros/rosdistro/master/ros.asc | sudo apt-key add - | |
sudo apt update | |
sudo apt install ros-melodic-joint-state-publisher-gui | |
mkdir -p ~/catkin_ws/src |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
docker run -p 6080:80 --shm-size=512m tiryoh/ros2-desktop-vnc:foxy | |
# Go to http://localhost:6080 and open a terminal | |
# Menu > System Tools > MATE Terminal | |
sudo apt update | |
mkdir -p ~/ros2_ws/src | |
cd ~/ros2_ws/src |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
docker run -p 6080:80 --shm-size=512m --name px4-gazebo-mavros -d dorowu/ubuntu-desktop-lxde-vnc:latest | |
http://localhost:6080 | |
sudo apt-key adv --keyserver keyserver.ubuntu.com --recv-keys 4EB27DB2A3B88B8B | |
sudo apt update | |
sudo apt install git -y |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
#!/bin/bash | |
## Bash script for setting up ROS Noetic (with Gazebo 11) development environment for PX4 on Ubuntu LTS (20.04). | |
## It installs the common dependencies for all targets (including Qt Creator) | |
## | |
## Installs: | |
## - Common dependencies libraries and tools as defined in `ubuntu_sim_common_deps.sh` | |
## - ROS Noetic (including Gazebo11) | |
## - MAVROS |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
// https://www.rcgroups.com/forums/showpost.php?p=48605917&postcount=299 | |
//Arduino/Teensy Flight Controller - dRehmFlight | |
//Author: Nicholas Rehm | |
//Project Start: 1/6/2020 | |
//Version: Beta 1.2 | |
/* | |
* | |
* If you are using this for an academic or scholarly project, please credit me in any presentations or publications: |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
# From Windows terminal | |
docker run -p 6080:80 --shm-size=512m --name ros_go1 -d tiryoh/ros-desktop-vnc:melodic | |
# Access the instance through the url | |
http://localhost:6080 | |
# From home directory in Docker | |
mkdir -p catkin_ws/src | |
# Go into catkin workspace |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
# From Windows terminal | |
docker run -p 6080:80 --shm-size=512m --name ros_go1 -d tiryoh/ros-desktop-vnc:melodic | |
# Access the instance through the url | |
http://localhost:6080 | |
# From home directory in Docker | |
mkdir -p catkin_ws/src | |
# Go into catkin workspace |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
#include "ros/ros.h" | |
#include "geometry_msgs/Twist.h" | |
#include <math.h> | |
#define PI 3.14 | |
int main(int argc, char **argv) | |
{ | |
ros::init(argc, argv, "dennis_test"); | |
ros::NodeHandle nh; |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
# Download image | |
https://www.dropbox.com/s/ayut7eqlasa8jwz/wsl_ubuntu_unitree_sdk.tar?dl=0 | |
# Import image (you will need to change your paths below) | |
wsl --import Unitree-SDK-Dev C:\Users\denni\Desktop C:\Users\denni\Downloads\wsl_ubuntu_unitree_sdk.tar | |
# List images to confirm it was imported | |
wsl -l -v | |
# Start the distribution |