Skip to content

Instantly share code, notes, and snippets.

View LimHyungTae's full-sized avatar
🎯
Focusing on the next paper!

Hyungtae Lim LimHyungTae

🎯
Focusing on the next paper!
View GitHub Profile
@LimHyungTae
LimHyungTae / project_vel2img.py
Created August 18, 2022 13:46
Projection Velodyne data into image plane in NAVER LABS dataset
import os
from PIL import Image, ImageDraw
import h5py
import numpy as np
from helper.intrinsics import *
import matplotlib.pyplot as plt
cmap = plt.cm.jet
import cv2
from helper.tf_helpers import get_T_c_l
import open3d
@LimHyungTae
LimHyungTae / EKF_SLAM.m
Created July 10, 2022 18:23
EKF SLAM example for a 2D mobile robot
function [] = ToyEKFSLAM()
randn('seed',1);
DTR = pi/180; % degree to radian
%% True initial condition
% The size is `mu_gt` is 4 + 10 = 14
mu_gt = [1; 1; 45*DTR; 1; % x, y, psi, V
4.6454; 7.0242; % landmark 1 (x1,y1)
6.5198; 4.7523; % landmark 2 (x2,y2)
1.6836; 5.4618; % landmark 3 (x3,y3)
@LimHyungTae
LimHyungTae / jackal_telekeyop.py
Created July 7, 2022 07:21
ROS Jackal Telekeyop in Window
from __future__ import print_function
import threading
import rospy
from geometry_msgs.msg import Twist
from geometry_msgs.msg import TwistStamped
import signal
@LimHyungTae
LimHyungTae / sagej.cls
Created May 23, 2022 08:38
Add comma in SAGEH format
\if@sageh
\usepackage[comma]{natbib}
\bibpunct{(}{)}{;}{}{\color{red},}{,}
\setlength{\bibsep}{1pt}
\setlength{\bibhang}{16pt}
\renewcommand{\bibfont}{\refsize}
% \renewcommand*{\nameyeardelim}{\addcomma\space}
\renewcommand\refname{{\normalsize References}}
\fi
#include "utility.h"
#include "lio_sam_de/cloud_info.h"
#include "lio_sam_de/save_map.h"
#include "de_msg/node.h"
#include <iomanip> // for std::setprecision()
//#include <pcl/common/transforms.h>
#include <gtsam/geometry/Rot3.h>
#include <gtsam/geometry/Pose3.h>
#include <gtsam/slam/PriorFactor.h>
#include <iostream>
#include <cmath>
#include <vector>
using namespace std;
#define DEG2RAD M_PI/180
#define RAD2DEG 180/M_PI
float calc_mean(float a1, float a2, std::string input_type="rad"){
/* -*- mode: C++ -*-
*
* Conversions between Latitude/Longitude and UTM
* (Universal Transverse Mercator) coordinates.
*
* License: Modified BSD Software License Agreement
*
* $Id$
*/
#include <Eigen/Core>
#include <iostream>
#include <omp.h>
#include <vector>
#include <chrono>
#include <random>
#include <pcl/point_types.h>
#include <pcl/point_cloud.h>
using namespace std;
@LimHyungTae
LimHyungTae / .vimrc
Last active March 7, 2023 01:47
vim config (.vimrc) (update: Match 7th, 2023)
set nocompatible " be iMproved, required
filetype off " required
" set the runtime path to include Vundle and initialize
set rtp+=~/.vim/bundle/Vundle.vim
call vundle#begin()
Plugin 'VundleVim/Vundle.vim'
Plugin 'Raimondi/delimitMate'
Plugin 'neocomplcache'
Plugin 'vim-airline/vim-airline'
// Author: [email protected] (Keir Mierle)
//
// Tutorial Author: [email protected] (임형태)
#include "ceres/ceres.h"
#include "glog/logging.h"
#include <vector>
#include <random>
#include <iomanip>