Skip to content

Instantly share code, notes, and snippets.

View KaushalkumarPatel's full-sized avatar
🎯
Focusing

Kaushal KP KaushalkumarPatel

🎯
Focusing
View GitHub Profile
@KaushalkumarPatel
KaushalkumarPatel / Dockerfile for Yolov8 (for GPU compability)
Last active January 28, 2025 09:56
Dockerfile to install & run Yolov8 on ROS Noetic (including GPU compability)
FROM nvidia/cudagl:11.4.2-base-ubuntu20.04
ENV DEBIAN_FRONTEND=noninteractive
# 2. Minimal ros setup and locales configuration
RUN apt-get update && apt-get install -y --no-install-recommends \
    locales \
    lsb-release \
    git \
    python3-pip \
#! /usr/bin/env python
import sys
import copy
import rospy
import moveit_commander
import moveit_msgs.msg
import geometry_msgs.msg
from math import pi
from std_msgs.msg import String
@KaushalkumarPatel
KaushalkumarPatel / kinect_handle.py
Created July 9, 2019 13:47 — forked from anonymous/kinect_handle.py
Code to detect and localise door handles using Kinect, libfreenect, OpenCV and ROS. For a project to open doors with the GummiArm soft robotic arm.
#!/usr/bin/env python
from __future__ import print_function
import sys
import rospy
import cv2
import numpy as np
import math
from sensor_msgs.msg import CameraInfo
from geometry_msgs.msg import Point
from sensor_msgs.msg import Image