Pinned Repositories
Colorful-Ball-Detection-ROS-ver
ROS wrapped version of Colorful-Ball-Detection. Performed in ROS Kinetic with Ubuntu 16.04 LTS. Based on the prior knowledge about the size of a ball, the algorithm estimates 3D position of the center of the ball. By denoting right as x, frontside as y, and upperside as z, the position of the ball with respect to the camera coordinate axis is represented on the result window.
essential-computer-vision
Fundamental examples in conventional computer vision and their implementations
evo
Python package for the evaluation of odometry and SLAM
laserscan_localizer
ROS package which detects reflective cylindrical marker points (i.e. objects which reflects light more than others) by utilizing sensor_msgs/LaserScan type ROS message.
mix-cal
Extrinsic Calibration of Multiple Inertial Sensors from Arbitrary Trajectories
programming-sip
Assorted Examples of Signal and Image Processing in MATLAB
ros-hands-on-project
Hands-on practice for ROS programming. Simple ROS packages are included.
vicon-mocap-package
ROS package for motion capture system in IRL UIUC
jongwonjlee's Repositories
jongwonjlee/mix-cal
Extrinsic Calibration of Multiple Inertial Sensors from Arbitrary Trajectories
jongwonjlee/Colorful-Ball-Detection-ROS-ver
ROS wrapped version of Colorful-Ball-Detection. Performed in ROS Kinetic with Ubuntu 16.04 LTS. Based on the prior knowledge about the size of a ball, the algorithm estimates 3D position of the center of the ball. By denoting right as x, frontside as y, and upperside as z, the position of the ball with respect to the camera coordinate axis is represented on the result window.
jongwonjlee/vicon-mocap-package
ROS package for motion capture system in IRL UIUC
jongwonjlee/evo
Python package for the evaluation of odometry and SLAM
jongwonjlee/code
Code for the book "Mastering OpenCV with Practical Computer Vision Projects" by Packt Publishing 2012.
jongwonjlee/essential-computer-vision
Fundamental examples in conventional computer vision and their implementations
jongwonjlee/laserscan_localizer
ROS package which detects reflective cylindrical marker points (i.e. objects which reflects light more than others) by utilizing sensor_msgs/LaserScan type ROS message.
jongwonjlee/programming-sip
Assorted Examples of Signal and Image Processing in MATLAB
jongwonjlee/ros-hands-on-project
Hands-on practice for ROS programming. Simple ROS packages are included.
jongwonjlee/ae598-3dv
jongwonjlee/Colorful-Ball-Detection-OpenCV-ver
A project detecting colorful balls by using a camera. This is being conducted as a part of Capstone Design 1 (ME400) at KAIST, in the spring, 2019.
jongwonjlee/evo-1
jongwonjlee/examples_CMake
CMake 사용법 정리
jongwonjlee/ORB_SLAM3_Marker
ORB-SLAM3: An Accurate Open-Source Library for Visual, Visual-Inertial and Multi-Map SLAM
jongwonjlee/orb_slam3_ros
A ROS implementation of ORB_SLAM3