An open API service providing repository metadata for many open source software ecosystems.

GitHub / liuzhenboo 2 Repositories

liuzhenboo@foxmail.com

liuzhenboo/mav_find_road

无人机丛林环境寻找可行道路

Language: Makefile - Size: 13.6 MB - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 11 - Forks: 0

liuzhenboo/bustub Fork of cmu-db/bustub

The BusTub Relational Database Management System (Educational)

Language: C++ - Size: 7.24 MB - Last synced at: almost 2 years ago - Pushed at: almost 2 years ago - Stars: 0 - Forks: 0

liuzhenboo/orbslam2-dense-point-cloud

为orbslam2加上稠密建图模块

Language: C++ - Size: 33.7 MB - Last synced at: about 2 years ago - Pushed at: over 5 years ago - Stars: 13 - Forks: 6

liuzhenboo/slam_test1

Language: C++ - Size: 2.93 KB - Last synced at: over 2 years ago - Pushed at: over 2 years ago - Stars: 0 - Forks: 0

liuzhenboo/slam_test

Size: 0 Bytes - Last synced at: over 2 years ago - Pushed at: over 2 years ago - Stars: 0 - Forks: 0

liuzhenboo/2D-SLAM-By-Nonlinear-Optimization

基于非线性优化的2Dslam仿真,实践前端数据关联,滑动窗口法,LM优化,FEJ。

Language: Python - Size: 6.31 MB - Last synced at: over 2 years ago - Pushed at: almost 5 years ago - Stars: 57 - Forks: 17

liuzhenboo/orb-extractor

基于orbslam2的orb特征点提取器

Language: C++ - Size: 1.79 MB - Last synced at: over 2 years ago - Pushed at: over 5 years ago - Stars: 17 - Forks: 6

liuzhenboo/EKF-2D-SLAM

EKF实现2维平面上的SLAM

Language: MATLAB - Size: 38.4 MB - Last synced at: over 2 years ago - Pushed at: over 5 years ago - Stars: 30 - Forks: 10

liuzhenboo/Shenlan-VIO-Course

深蓝VIO课程文档,代码。

Language: C++ - Size: 82.7 MB - Last synced at: over 2 years ago - Pushed at: over 5 years ago - Stars: 6 - Forks: 3

liuzhenboo/Active-Road-Mapping

面向丛林环境人行道路探测与重建的无人机主动定位与建图技术; Active Mapping based ORB_SLAM3

Language: C++ - Size: 5.27 MB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 4 - Forks: 2

liuzhenboo/Object-Aware-SLAM Fork of caobugai12138/Object-Aware-SLAM

This is the open source of my first paper 《Object-Aware SLAM Based on Efficient Quadric Initialization and Joint Data Association》, which has been accepted by RA-L & IROS 2022.

Size: 2.99 MB - Last synced at: over 2 years ago - Pushed at: about 3 years ago - Stars: 0 - Forks: 0

liuzhenboo/chinese-programmer-wrong-pronunciation Fork of shimohq/chinese-programmer-wrong-pronunciation

中国程序员容易发音错误的单词

Size: 275 KB - Last synced at: over 2 years ago - Pushed at: about 3 years ago - Stars: 0 - Forks: 0

liuzhenboo/hungarian-algorithm Fork of tdedecko/hungarian-algorithm

Implementation of Hungarian Algorithm with Python and NumPy

Size: 15.6 KB - Last synced at: over 2 years ago - Pushed at: almost 7 years ago - Stars: 0 - Forks: 0

liuzhenboo/hungarian-algorithm-cpp Fork of mcximing/hungarian-algorithm-cpp

A C++ wrapper for a hungarian algorithm implementation

Size: 5.86 KB - Last synced at: over 2 years ago - Pushed at: almost 5 years ago - Stars: 0 - Forks: 0

liuzhenboo/HumanSystemOptimization Fork of zijie0/HumanSystemOptimization

健康学习到150岁 - 人体系统调优不完全指南

Size: 25.4 KB - Last synced at: over 2 years ago - Pushed at: about 3 years ago - Stars: 0 - Forks: 0

liuzhenboo/ddcrp-gibbs Fork of laurimi/ddcrp-gibbs

Gibbs sampler for the Distance Dependent Chinese Restaurant Process

Size: 40 KB - Last synced at: over 2 years ago - Pushed at: almost 8 years ago - Stars: 0 - Forks: 0

liuzhenboo/rgbd_calibration Fork of iaslab-unipd/rgbd_calibration

RGBD Calibration

Size: 1.96 MB - Last synced at: over 2 years ago - Pushed at: over 6 years ago - Stars: 0 - Forks: 0

liuzhenboo/CPL

good job!//MS-Thesis: Proposed a new loss function for estimating Camera Calibration parameters along with a new dataset -- (CVGL Camera Calibration Dataset)

Size: 23.3 MB - Last synced at: over 2 years ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 0

liuzhenboo/Optimization-of-Feature-Point-Matching-Algorithm-Based-on-Wasserstein-Distance

Language: C++ - Size: 2.39 MB - Last synced at: over 2 years ago - Pushed at: about 3 years ago - Stars: 0 - Forks: 0

liuzhenboo/wasserstein- Fork of gnardari/wasserstein

Header only C++ implementation of the Wasserstein distance (or earth mover's distance)

Size: 22.5 KB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/GTM Fork of josefmaierfl/GTM

Interface for Ground Truth Matches to test vision based algorithms

Size: 16 MB - Last synced at: over 2 years ago - Pushed at: almost 8 years ago - Stars: 0 - Forks: 0

liuzhenboo/LibQPEP Fork of zarathustr/LibQPEP

A library for solving generalized quadratic pose estimation problems and related uncertainty description

Size: 70.2 MB - Last synced at: over 2 years ago - Pushed at: about 3 years ago - Stars: 0 - Forks: 0

liuzhenboo/activeSLAM-in-deformable-environments Fork of MengyaXu/activeSLAM-in-deformable-environments

Size: 2.03 MB - Last synced at: over 2 years ago - Pushed at: almost 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/ML-NOTE Fork of yhangf/ML-NOTE

:orange_book:慢慢整理所学的机器学习算法,并根据自己所理解的样子叙述出来。(注重数学推导)

Size: 25.1 MB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/matlab_cuboid_detect Fork of shichaoy/matlab_cuboid_detect

cubeslam的3d检测matlab版本:Detect 3D cuboid object pose from single image.

Size: 580 KB - Last synced at: over 2 years ago - Pushed at: almost 7 years ago - Stars: 0 - Forks: 0

liuzhenboo/EAO-SLAM-Final Fork of Be997398715/EAO-SLAM-Final

final push for EAO-SLAM-Improve

Size: 86.4 MB - Last synced at: over 2 years ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 0

liuzhenboo/Ground-Cloud-Segmentation-under-UAV-Platform

A Robust Ground Cloud Segmentation Algorithm Based on Depth Camera under UAV Platform

Size: 0 Bytes - Last synced at: over 2 years ago - Pushed at: about 3 years ago - Stars: 0 - Forks: 0

liuzhenboo/E2ES Fork of HKPolyU-UAV/E2ES

MAV simulation on Gazebo

Size: 51.3 MB - Last synced at: over 2 years ago - Pushed at: almost 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/Multi_Sensor_Fusion_SLAM

多传感器融合,实现定位与建图。working!

Language: C++ - Size: 4.04 MB - Last synced at: over 2 years ago - Pushed at: almost 5 years ago - Stars: 5 - Forks: 1

liuzhenboo/VINS-Fusion Fork of HKUST-Aerial-Robotics/VINS-Fusion

An optimization-based multi-sensor state estimator

Size: 78.9 MB - Last synced at: over 2 years ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 0

liuzhenboo/RIEKF-based-active-SLAM Fork of MengyaXu/RIEKF-based-active-SLAM

Size: 60.8 MB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/ROS-Academy-for-Beginners Fork of sychaichangkun/ROS-Academy-for-Beginners

中国大学MOOC《机器人操作系统入门》代码示例 ROS tutorial

Size: 44.4 MB - Last synced at: over 2 years ago - Pushed at: over 6 years ago - Stars: 0 - Forks: 0

liuzhenboo/cs-self-learning Fork of PKUFlyingPig/cs-self-learning

计算机自学指南

Size: 951 KB - Last synced at: over 2 years ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 0

liuzhenboo/linux Fork of torvalds/linux

Linux kernel source tree

Size: 3.4 GB - Last synced at: over 2 years ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 0

liuzhenboo/rpg_svo_pro_open Fork of uzh-rpg/rpg_svo_pro_open

Size: 15.5 MB - Last synced at: over 2 years ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 0

liuzhenboo/MAV_Segment_Ground_HaHaaa

无人机地面分割

Size: 25.4 KB - Last synced at: over 2 years ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 0

liuzhenboo/FANAC_KAREL_SOCKET

karel写的发那科机械臂的通讯协议

Size: 12.7 KB - Last synced at: over 2 years ago - Pushed at: almost 5 years ago - Stars: 0 - Forks: 1

liuzhenboo/Matlab_Algorithm

基于Matlab的算法demo,全面拥抱matlab

Size: 0 Bytes - Last synced at: over 2 years ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 0

liuzhenboo/coxgraph Fork of zju3dv/coxgraph

Code for "Coxgraph: Multi-Robot Collaborative, Globally Consistent, Online Dense Reconstruction System", IROS 2021 Best Paper Award Finalist on Safety, Security, and Rescue Robotics in memory of Motohiro Kisoi

Size: 79.1 KB - Last synced at: over 2 years ago - Pushed at: almost 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/Submapping--Graph-SLAM Fork of israni/Submapping--Graph-SLAM

The effects of submapping on Graph-SLAM were studied with a number of datasets.

Size: 58.1 MB - Last synced at: over 2 years ago - Pushed at: almost 7 years ago - Stars: 0 - Forks: 0

liuzhenboo/ICRA2021PaperList Fork of dectrfov/ICRA2021PaperList

ICRA 2021 paper list

Size: 479 KB - Last synced at: over 2 years ago - Pushed at: about 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/HybVIO Fork of SpectacularAI/HybVIO

HybVIO visual-inertial odometry and SLAM system

Size: 299 KB - Last synced at: over 2 years ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 0

liuzhenboo/tiny-differentiable-simulator Fork of erwincoumans/tiny-differentiable-simulator

Tiny Differentiable Simulator is a header-only C++ and CUDA physics library for reinforcement learning and robotics with zero dependencies.

Size: 22.7 MB - Last synced at: over 2 years ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 0

liuzhenboo/yaml-cpp Fork of jbeder/yaml-cpp

A YAML parser and emitter in C++

Size: 3.93 MB - Last synced at: over 2 years ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 0

liuzhenboo/guided_filter_point_cloud_denoising Fork of jediofgever/guided_filter_point_cloud_denoising

Denoising of Point Cloud with Guided Filter

Size: 2.9 MB - Last synced at: over 2 years ago - Pushed at: almost 5 years ago - Stars: 0 - Forks: 0

liuzhenboo/guided-filter-point-cloud-denoise Fork of aipiano/guided-filter-point-cloud-denoise

Use guided filter to reduce the noise of a 3d point cloud.

Size: 10.1 MB - Last synced at: over 2 years ago - Pushed at: about 6 years ago - Stars: 0 - Forks: 0

liuzhenboo/basalt-mirror Fork of VladyslavUsenko/basalt-mirror

Mirror of the Basalt repository. All pull requests and issues should be sent to https://gitlab.com/VladyslavUsenko/basalt

Size: 17.7 MB - Last synced at: over 2 years ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 0

liuzhenboo/Lidar-Segementation Fork of wangx1996/Lidar-Segementation

An implementation on "Curved-Voxel Clustering for Accurate Segmentation of 3D LiDAR Point Clouds with Real-Time Performance" from IROS 2019

Size: 1.92 MB - Last synced at: over 2 years ago - Pushed at: almost 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/doing_the_PhD Fork of shengyp/doing_the_PhD

Size: 71.1 MB - Last synced at: over 2 years ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 0

liuzhenboo/semantic_slam Fork of floatlazer/semantic_slam

Real time semantic slam in ROS with a hand held RGB-D camera

Size: 43.8 MB - Last synced at: over 2 years ago - Pushed at: about 6 years ago - Stars: 0 - Forks: 0

liuzhenboo/FIESTA Fork of HKUST-Aerial-Robotics/FIESTA

Fast Incremental Euclidean Distance Fields for Online Motion Planning of Aerial Robots

Size: 2.39 MB - Last synced at: over 2 years ago - Pushed at: almost 6 years ago - Stars: 0 - Forks: 0

liuzhenboo/Fast-Ground-Segmentation-Based-on-JPC Fork of wangx1996/Fast-Ground-Segmentation-Based-on-JPC

An implementation on "Shen Z, Liang H, Lin L, Wang Z, Huang W, Yu J. Fast Ground Segmentation for 3D LiDAR Point Cloud Based on Jump-Convolution-Process. Remote Sensing. 2021; 13(16):3239. https://doi.org/10.3390/rs13163239"

Size: 15.4 MB - Last synced at: over 2 years ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 0

liuzhenboo/glocal_exploration Fork of ethz-asl/glocal_exploration

Efficient local and global exploration on submap collections with changing past pose estimates.

Size: 816 KB - Last synced at: over 2 years ago - Pushed at: about 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/voxblox-plusplus Fork of ethz-asl/voxblox-plusplus

A volumetric object-level semantic mapping framework.

Size: 2.6 MB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/depth_segmentation Fork of ethz-asl/depth_segmentation

A collection of segmentation methods working on depth images

Size: 35.2 MB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/SegmentationMapping Fork of UMich-BipedLab/SegmentationMapping

Size: 54 MB - Last synced at: over 2 years ago - Pushed at: almost 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/voxblox_ground_truth Fork of ethz-asl/voxblox_ground_truth

Create ground truth voxblox maps from Gazebo worlds or .ply files

Size: 1.13 MB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/USTC-Course Fork of USTC-Resource/USTC-Course

:heart:中国科学技术大学课程资源

Size: 145 MB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/labelme Fork of wkentaro/labelme

Image Polygonal Annotation with Python (polygon, rectangle, circle, line, point and image-level flag annotation).

Size: 44.3 MB - Last synced at: over 2 years ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 0

liuzhenboo/semantic-kitti-api Fork of PRBonn/semantic-kitti-api

SemanticKITTI API for visualizing dataset, processing data, and evaluating results.

Size: 80.1 KB - Last synced at: over 2 years ago - Pushed at: almost 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/point_labeler Fork of jbehley/point_labeler

My awesome point cloud labeling tool

Size: 346 KB - Last synced at: over 2 years ago - Pushed at: about 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/cblox Fork of ethz-asl/cblox

Voxblox-based submapping

Size: 527 KB - Last synced at: over 2 years ago - Pushed at: almost 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/OrcVIO-Stereo-Python Fork of shanmo/OrcVIO-Stereo-Python

Python version of OrcVIO Stereo

Size: 324 KB - Last synced at: over 2 years ago - Pushed at: about 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/semantic_3d_mapping Fork of shichaoy/semantic_3d_mapping

Semantic 3D Occupancy Mapping through Efficient High Order CRFs

Size: 28.9 MB - Last synced at: over 2 years ago - Pushed at: about 6 years ago - Stars: 0 - Forks: 0

liuzhenboo/stereo_online_calibration

Size: 0 Bytes - Last synced at: over 2 years ago - Pushed at: about 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/traversability_mapping Fork of TixiaoShan/traversability_mapping

Bayesian Generalized Kernel Inference for Terrain Traversability Mapping

Size: 1.12 MB - Last synced at: over 2 years ago - Pushed at: almost 5 years ago - Stars: 0 - Forks: 0

liuzhenboo/open_quadtree_mapping Fork of HKUST-Aerial-Robotics/open_quadtree_mapping

This is a monocular dense mapping system corresponding to IROS 2018 "Quadtree-accelerated Real-time Monocular Dense Mapping"

Size: 2.92 MB - Last synced at: over 2 years ago - Pushed at: almost 7 years ago - Stars: 0 - Forks: 0

liuzhenboo/XTDrone Fork of robin-shaun/XTDrone

UAV Simulation Platform based on PX4, ROS and Gazebo

Size: 447 MB - Last synced at: over 2 years ago - Pushed at: about 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/ardrone_simulator_gazebo7 Fork of iolyp/ardrone_simulator_gazebo7

An edited tum_ardrone_simulator that works with gazebo7 + ar_track_alvar gazebo models and world

Size: 739 KB - Last synced at: over 2 years ago - Pushed at: over 5 years ago - Stars: 0 - Forks: 0

liuzhenboo/qqbot Fork of pandolia/qqbot

QQBot: A conversation robot base on Tencent's SmartQQ

Size: 1.24 MB - Last synced at: over 2 years ago - Pushed at: almost 5 years ago - Stars: 0 - Forks: 0

liuzhenboo/rotors_simulator Fork of ethz-asl/rotors_simulator

RotorS is a UAV gazebo simulator

Size: 187 MB - Last synced at: over 2 years ago - Pushed at: about 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/hexo-theme-butterfly Fork of jerryc127/hexo-theme-butterfly

🦋 A Hexo Theme: Butterfly

Size: 2.14 MB - Last synced at: over 2 years ago - Pushed at: about 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/HuaWei_CodeCraft2021

华为软件精英挑战赛2021比赛

Language: C++ - Size: 11.1 MB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 1 - Forks: 0

liuzhenboo/ORB_SLAM3 Fork of UZ-SLAMLab/ORB_SLAM3

光流与描述子匹配结合的VIO,并将局部地图以点云的形式发布.

Language: C++ - Size: 174 MB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 1 - Forks: 0

liuzhenboo/pytorch Fork of pytorch/pytorch

Tensors and Dynamic neural networks in Python with strong GPU acceleration

Size: 267 MB - Last synced at: over 2 years ago - Pushed at: about 5 years ago - Stars: 0 - Forks: 0

liuzhenboo/monodepth2 Fork of nianticlabs/monodepth2

[ICCV 2019] Monocular depth estimation from a single image

Size: 10 MB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/PSMNet Fork of JiaRenChang/PSMNet

Pyramid Stereo Matching Network (CVPR2018)

Size: 112 KB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/surfelmeshing Fork of puzzlepaint/surfelmeshing

Real-time surfel-based mesh reconstruction from RGB-D video.

Size: 3.35 MB - Last synced at: over 2 years ago - Pushed at: almost 5 years ago - Stars: 0 - Forks: 0

liuzhenboo/badslam Fork of ETH3D/badslam

Bundle Adjusted Direct RGB-D SLAM

Size: 6.64 MB - Last synced at: over 2 years ago - Pushed at: about 5 years ago - Stars: 0 - Forks: 0

liuzhenboo/InfiniTAM Fork of victorprad/InfiniTAM

A Framework for the Volumetric Integration of Depth Images

Size: 3.45 MB - Last synced at: over 2 years ago - Pushed at: over 5 years ago - Stars: 0 - Forks: 0

liuzhenboo/Kintinuous Fork of mp3guy/Kintinuous

Real-time large scale dense visual SLAM system

Size: 22.7 MB - Last synced at: over 2 years ago - Pushed at: about 7 years ago - Stars: 0 - Forks: 0

liuzhenboo/ORB_SLAM2_SSD_Semantic Fork of Ewenwan/ORB_SLAM2_SSD_Semantic

动态语义SLAM 目标检测+VSLAM+光流/多视角几何动态物体检测+octomap地图+目标数据库

Size: 26.7 MB - Last synced at: over 2 years ago - Pushed at: almost 5 years ago - Stars: 0 - Forks: 0

liuzhenboo/apollo Fork of ApolloAuto/apollo

An open autonomous driving platform

Size: 2.23 GB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/plane_fit_ground_filter Fork of AbangLZU/plane_fit_ground_filter

A point cloud ground filter based on ground plane fitting

Size: 8.79 KB - Last synced at: over 2 years ago - Pushed at: over 6 years ago - Stars: 0 - Forks: 0

liuzhenboo/rtabmap Fork of introlab/rtabmap

RTAB-Map library and standalone application

Size: 54.6 MB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 0 - Forks: 1

liuzhenboo/2DMapping-and-Navigation

build a 2D grid map and navigation based ROS

Size: 0 Bytes - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/DMPC-for-multi-agent Fork of chengji253/DMPC-for-multi-agent

Distributed model predictive control for multi-agent point-to-point transitions.

Size: 2.42 MB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 0 - Forks: 0

liuzhenboo/IROS20-SLAM-papers Fork of gisbi-kim/IROS20-SLAM-papers

A personal list-up

Size: 1.95 KB - Last synced at: over 2 years ago - Pushed at: almost 5 years ago - Stars: 0 - Forks: 0

liuzhenboo/Stereo-Visual-Odometry

stereo vo system

Language: C++ - Size: 11.5 MB - Last synced at: over 2 years ago - Pushed at: almost 5 years ago - Stars: 6 - Forks: 2

liuzhenboo/FANAC_4806

Size: 1.95 KB - Last synced at: over 2 years ago - Pushed at: almost 5 years ago - Stars: 0 - Forks: 0

liuzhenboo/vo-init

orbslam2,特征点法单目初始化,双线程分别计算基础矩阵与本质矩阵。

Language: C++ - Size: 698 KB - Last synced at: over 2 years ago - Pushed at: over 5 years ago - Stars: 4 - Forks: 2

liuzhenboo/classic-DSA

学习数据结构与算法。

Language: C++ - Size: 9.77 KB - Last synced at: over 2 years ago - Pushed at: almost 5 years ago - Stars: 0 - Forks: 0

liuzhenboo/-

学习数据结构与算法

Size: 0 Bytes - Last synced at: over 2 years ago - Pushed at: almost 5 years ago - Stars: 0 - Forks: 0

liuzhenboo/communication-protocol

udp协议

Size: 0 Bytes - Last synced at: over 2 years ago - Pushed at: almost 5 years ago - Stars: 0 - Forks: 0

liuzhenboo/png_to_klg Fork of HTLife/png_to_klg

klg format convertor for ElasticFusion (ICL-NUM file)

Size: 3.05 MB - Last synced at: over 2 years ago - Pushed at: about 5 years ago - Stars: 0 - Forks: 0

liuzhenboo/zed-ros-wrapper Fork of stereolabs/zed-ros-wrapper

ROS wrapper for the ZED SDK

Size: 11.8 MB - Last synced at: over 2 years ago - Pushed at: about 5 years ago - Stars: 1 - Forks: 0

liuzhenboo/zed-examples Fork of stereolabs/zed-examples

ZED SDK Example projects

Size: 460 KB - Last synced at: over 2 years ago - Pushed at: about 5 years ago - Stars: 1 - Forks: 1

liuzhenboo/Kimera-Semantics Fork of MIT-SPARK/Kimera-Semantics

Real-Time 3D Semantic Reconstruction from 2D data

Size: 76.9 MB - Last synced at: over 2 years ago - Pushed at: about 5 years ago - Stars: 1 - Forks: 0

liuzhenboo/Kimera-VIO Fork of MIT-SPARK/Kimera-VIO

Visual Inertial Odometry with SLAM capabilities and 3D Mesh generation.

Size: 174 MB - Last synced at: over 2 years ago - Pushed at: about 5 years ago - Stars: 1 - Forks: 0

liuzhenboo/MVision Fork of Ewenwan/MVision

机器人视觉 移动机器人 VS-SLAM ORB-SLAM2 深度学习目标检测 yolov3 行为检测 opencv PCL 机器学习 无人驾驶

Size: 883 MB - Last synced at: over 2 years ago - Pushed at: about 5 years ago - Stars: 0 - Forks: 0