Skip to content

Instantly share code, notes, and snippets.

// *.PCD 파일 읽기
pcl::PointCloud<pcl::PointXYZRGB>::Ptr cloud (new pcl::PointCloud<pcl::PointXYZRGB>);
pcl::io::loadPCDFile ("cloud_cluster_0_white.pcd", *cloud);
@adioshun
adioshun / ddynamic_reconfigure.py
Created November 2, 2018 07:32
ROS Dynamic Reconfigure
#!/usr/bin/env python
"""
Dynamic dynamic reconfigure server.
Just register your variables for the dynamic reconfigure
and call start with a callback.
Author: Sammy Pfeiffer
"""
@adioshun
adioshun / multi_object_tracking.py
Last active March 29, 2022 07:50
Tracking multiple objects with OpenCV
# https://www.pyimagesearch.com/2018/08/06/tracking-multiple-objects-with-opencv/
# USAGE
# python multi_object_tracking.py --video videos/soccer_01.mp4 --tracker csrt
# import the necessary packages
from imutils.video import VideoStream
import argparse
import imutils
import time
@adioshun
adioshun / centroidtracker.py
Created August 13, 2018 05:51
Simple object tracking with OpenCV
# https://www.pyimagesearch.com/2018/07/23/simple-object-tracking-with-opencv/
# import the necessary packages
from scipy.spatial import distance as dist
from collections import OrderedDict
import numpy as np
class CentroidTracker():
def __init__(self, maxDisappeared=50):
# initialize the next unique object ID along with two ordered
#!/usr/bin/env python
# import roslib
import rospy
from std_msgs.msg import Header
from sensor_msgs.msg import PointCloud2, PointField
import numpy as np
import sensor_msgs.point_cloud2 as pc2
import py3d
# -*- coding: utf-8 -*-
c.NotebookApp.ip = '*' #L158
c.NotebookApp.open_browser = False # L201 원격접속으로 활용할 것이기 때문에 비활성화 시켰다.
c.NotebookApp.port = 8888 # L213 포트를 설정해준다. 기본포트로 8888이 자동 배정된다.
c.NotebookApp.password = 'sha1:a8dee43a3a44:b18f1ad149a60efb4838da44cf127985d64a5e70' # L210 python 실행후 from notebook.auth import passwd; passwd\(\)
# c.NotebookApp.password = 'sha1:a4a97a70ed7c:a554dcc8f9c76c44129cb9bce3d954a6d8bfc1ae' #snu2018
# c.NotebookApp.password = 'sha1:834d30a0973a:3ff75a3b19f0aa52bf6402eb8778b7fa6da04537' #ubuntu
c.NotebookApp.notebook_dir = '/workspace' # L195 기본 디렉터리를 지정시켜준다.
# Use mouse for 1.8
setw -g mode-mouse on
set -g mouse-select-window on
set -g mouse-select-pane on
set -g mouse-resize-pane on
set -g mouse-utf on
#!/usr/bin/env python
# Copyright (C) 2017 Electric Movement Inc.
#
# This file is part of Robotic Arm: Pick and Place project for Udacity
# Robotics nano-degree program
#
# All Rights Reserved.
# Author: Harsh Pandya
@adioshun
adioshun / CMakeLists.txt
Last active June 5, 2019 02:32
PCL test code
cmake_minimum_required(VERSION 2.8 FATAL_ERROR)
project(pcl-test)
find_package(PCL 1.2 REQUIRED)
include_directories(${PCL_INCLUDE_DIRS})
link_directories(${PCL_LIBRARY_DIRS})
add_definitions(${PCL_DEFINITIONS})
add_executable(pcl-test main.cpp)
target_link_libraries(pcl-test ${PCL_LIBRARIES})
@adioshun
adioshun / CMakeLists.txt
Created May 2, 2018 02:03
Lidar Visualization
cmake_minimum_required(VERSION 2.6 FATAL_ERROR)
project(range_image_visualization)
find_package(PCL 1.3 REQUIRED)
include_directories(${PCL_INCLUDE_DIRS})
link_directories(${PCL_LIBRARY_DIRS})
add_definitions(${PCL_DEFINITIONS})