Skip to content

Instantly share code, notes, and snippets.

View DanielTakeshi's full-sized avatar
🎯
Focusing

Daniel Seita DanielTakeshi

🎯
Focusing
View GitHub Profile
@DanielTakeshi
DanielTakeshi / hsv_segmenter.py
Created March 21, 2022 17:37 — forked from thomasweng15/hsv_segmenter.py
Segment HSV from an image rostopic using OpenCV sliders
import cv2
import rospy
import argparse
import numpy as np
import matplotlib.pyplot as plt
from cv_bridge import CvBridge
from sensor_msgs.msg import Image
class Segmenter():
def __init__(self, args):
@DanielTakeshi
DanielTakeshi / UR5_IK.py
Last active January 31, 2024 16:37
Isaac Gym, UR5 Inverse Kinematics to target, CPU vs GPU differences
"""
Runs IK to get the UR5 end-effector to reach a target. Inspect CPU vs GPU mode.
Use a yellow sphere to show the tip of the end-effector, and a blue sphere to
show the target. These spheres are only used for debugging / visualization.
"""
from isaacgym import gymapi
from isaacgym import gymutil
from isaacgym import gymtorch
from isaacgym.torch_utils import (quat_conjugate, quat_mul, quat_apply)
import numpy as np
"""
Copyright (c) 2020, NVIDIA CORPORATION. All rights reserved.
NVIDIA CORPORATION and its licensors retain all intellectual property
and proprietary rights in and to this software, related documentation
and any modifications thereto. Any use, reproduction, disclosure or
distribution of this software and related documentation without an express
license agreement from NVIDIA CORPORATION is strictly prohibited.
Franka Cube Pick
@DanielTakeshi
DanielTakeshi / Reporting_Errors.md
Last active January 8, 2024 04:45
Guide to Reporting Software Errors

Guide to Reporting Errors (CSCI 545, Spring 2024)

Note: this guide has been written for CSCI 545, Introduction to Robotics, taught by Daniel Seita in Spring 2024. We have a policy that students must state that they have read this guide before requesting software help. This is designed for the benefit of both the course staff but also for the students.

This is a short guide on how to report code-related errors. If you run into errors, following these guidelines will increase the chances that your issue gets quickly resolved. Otherwise, it might result in a protracted