Skip to content

Instantly share code, notes, and snippets.

View hyxhope's full-sized avatar

A sad joker hyxhope

  • Beihang University.
  • Zhejiang, China
View GitHub Profile
@hyxhope
hyxhope / odomMapping.py
Created March 30, 2021 02:54
LIO-SAM里程计建图
# !/usr/bin/env python2
# coding=utf-8
from __future__ import absolute_import, print_function
import os
import ros_numpy
import rospy
import message_filters
@hyxhope
hyxhope / rtk2gps.py
Created March 31, 2021 07:55
RTK转GPS
#!/usr/bin/env python
# coding=utf-8
from __future__ import print_function, division
from geometry_msgs.msg import Quaternion, Point
from sensor_msgs.msg import NavSatFix
from serial_port.msg import rtk
from nav_msgs.msg import Odometry
import rospy
import numpy as np
@hyxhope
hyxhope / gt_mapping.py
Last active March 31, 2021 07:59
Groundtruth建图
# !/usr/bin/env python2
# coding=utf-8
from __future__ import absolute_import, print_function
import os
import numpy as np
import numpy.linalg as LA
import open3d as o3d
import message_filters
@hyxhope
hyxhope / save_pcd_odom.py
Last active September 9, 2022 03:10
save_pcd_odom.py
# !/usr/bin/env python3
# coding=utf-8
from __future__ import print_function, division, absolute_import
import rospy
from sensor_msgs.msg import PointCloud2
from nav_msgs.msg import Odometry
import message_filters
import numpy as np
@hyxhope
hyxhope / sim_save.py
Last active March 2, 2023 15:53
simulation_bin_traj_save_scripts
# !/usr/bin/env python2
# coding=utf-8
from __future__ import absolute_import, print_function
import os
import ros_numpy
import rospy
import message_filters
import tf
@hyxhope
hyxhope / gt_mapping.py
Created March 2, 2023 15:55
vis_submap_using_kitti_format
# !/usr/bin/env python3
# coding=utf-8
import os
import sys
import array
# import cv2
import numpy as np
import numpy.linalg as LA
@hyxhope
hyxhope / GTO.py
Created April 21, 2023 07:54 — forked from HViktorTsoi/GTO.py
hilti2022 experiment
import copy
import time
import open3d as o3d
import os
from collections import defaultdict
import numpy as np
import numpy.linalg as LA
import gtsam
import tqdm