Skip to content

Instantly share code, notes, and snippets.

View KaushalkumarPatel's full-sized avatar
🎯
Focusing

Kaushalkumar Patel KaushalkumarPatel

🎯
Focusing
View GitHub Profile
#! /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