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

Topic: "pcl-library"

HuangCongQing/pcl-learning

🔥PCL(Point Cloud Library)点云库学习记录

Language: C++ - Size: 34.3 MB - Last synced at: 8 days ago - Pushed at: 3 months ago - Stars: 1,731 - Forks: 419

SS47816/lidar_obstacle_detector

3D LiDAR Object Detection & Tracking using Euclidean Clustering, RANSAC, & Hungarian Algorithm

Language: C++ - Size: 30 MB - Last synced at: 10 days ago - Pushed at: about 1 year ago - Stars: 310 - Forks: 56

fverdoja/Fast-3D-Pointcloud-Segmentation

Fast 3D point cloud segmentation using supervoxels with geometry and color for 3D scene understanding

Language: C++ - Size: 13.5 MB - Last synced at: about 1 month ago - Pushed at: almost 5 years ago - Stars: 227 - Forks: 54

codebydant/DBScan-PCL-Optimized

DBScan algorithm using Octrees to cluster 3D points in a space with PCL Library

Language: C++ - Size: 53.9 MB - Last synced at: 3 months ago - Pushed at: over 2 years ago - Stars: 188 - Forks: 43

codebydant/pointcloudToMesh

C++ application to convert pcd file, ply file, txt file or xyz point cloud to MESH representation (Gp3).

Language: C++ - Size: 321 KB - Last synced at: 7 months ago - Pushed at: over 2 years ago - Stars: 161 - Forks: 35

inflatablefriends/lastfm

Portable .Net library for Last.fm

Language: C# - Size: 23.4 MB - Last synced at: 14 days ago - Pushed at: over 1 year ago - Stars: 99 - Forks: 60

akhilthomas17/pointcloud-landmarks-extractor

Tools to detect and classify landmarks (currently, trees and pole-like objects) from point cloud data

Language: C++ - Size: 8.46 MB - Last synced at: about 1 month ago - Pushed at: over 5 years ago - Stars: 80 - Forks: 38

sining1989/PointCloudTools

PointCloudTools是一款在Windows平台基于VS2017、Qt5.9.5、PCL1.8.1、VTK8.0.0源码编译开发的专门处理点云(.pcd、.ply、.obj等格式)文件的可视化工具。 该工具点云可视化使用的是vtk8.0.0编译生成的QVTKWidget窗口控件,使用PCL可以对点云进行滤波(filter)、特征提取(features)、关键点(keypoint)、 分割(segmentation)、识别(recognition)、可视化(visualization)等操作,可以对所有点云进行WGS84到平面坐标系转换,也包含将经纬度坐标转为UTM坐标的方法。 下载64位PCL1.8.164位下载路径:https://github.com/PointCloudLibrary/pcl/releases或http://unanancyowen.com/en/pcl181 PCL1.8.1对应的VTK版本为8.0.0,下载地址:https://gitlab.kitware.com/vtk/vtk/tree/v8.0.0

Language: C++ - Size: 200 KB - Last synced at: about 1 month ago - Pushed at: almost 4 years ago - Stars: 71 - Forks: 16

VirtualRoyalty/PointCloudSegmentation

The research project based on Semantic KITTTI dataset, 3d Point Cloud Segmentation , Obstacle Detection

Language: Jupyter Notebook - Size: 780 MB - Last synced at: about 2 years ago - Pushed at: almost 3 years ago - Stars: 61 - Forks: 14

kcg2015/lidar_ground_plane_and_obstacles_detections

Python and C++ examples that show shows how to process 3-D Lidar data by segmenting the ground plane and finding obstacles.

Language: Jupyter Notebook - Size: 30.8 MB - Last synced at: about 2 years ago - Pushed at: almost 5 years ago - Stars: 35 - Forks: 13

codebydant/sfM_danPipeline

A simple structure from motion pipeline in c++ using OpenCV and PCL

Language: C++ - Size: 94.4 MB - Last synced at: 7 months ago - Pushed at: about 1 year ago - Stars: 29 - Forks: 8

codebydant/upsamplingCloudPCL

Upsampling method for an input cloud using mls method of PCL

Language: C++ - Size: 501 KB - Last synced at: 7 months ago - Pushed at: over 2 years ago - Stars: 28 - Forks: 5

iralabdisco/probabilistic_point_clouds_registration

Probabilistic Point Clouds Registration

Language: C++ - Size: 79.7 MB - Last synced at: over 1 year ago - Pushed at: over 2 years ago - Stars: 23 - Forks: 10

Husseinhj/RateLimiting.NET

Rate Limiting (debounce, throttle) for C# Portable Class Library

Language: C# - Size: 9.21 MB - Last synced at: 16 days ago - Pushed at: over 5 years ago - Stars: 22 - Forks: 5

ChevronOne/pc_alignment_tools

Calibration of LiDAR-Sensors - PointCloud Alignment/Registration tools with PCL & ROS

Language: C++ - Size: 22.1 MB - Last synced at: over 1 year ago - Pushed at: over 3 years ago - Stars: 21 - Forks: 3

PPokorski/laser_object_tracker

ROS package for Detection and Tracking of Multiple Objects (DATMO), code of my master's thesis "Prediction of Objects' Motion in the Vicinity of Robot".

Language: C++ - Size: 447 KB - Last synced at: over 1 year ago - Pushed at: about 5 years ago - Stars: 21 - Forks: 5

m0glan/pcljava 📦

A port of the Point Cloud Library (PCL) using Java Native Interface (JNI).

Language: C++ - Size: 254 MB - Last synced at: over 1 year ago - Pushed at: almost 4 years ago - Stars: 19 - Forks: 11

Nandite/Pcl-Optics

C++ Implementation of the OPTICS algorithm compatible with the Point Cloud Library.

Language: C++ - Size: 4.31 MB - Last synced at: 7 days ago - Pushed at: over 2 years ago - Stars: 15 - Forks: 4

hoangcuongbk80/my_pcl_tutotial

Language: CMake - Size: 434 KB - Last synced at: about 2 years ago - Pushed at: over 5 years ago - Stars: 15 - Forks: 1

falahati/HybridBridge

This is a PCL library that let you connect JavaScript on the browser side to the C# side by proxying C# code.

Language: C# - Size: 1.16 MB - Last synced at: 10 days ago - Pushed at: almost 3 years ago - Stars: 14 - Forks: 4

lmy1108/Point2Mesh-website

A website based on SpringMVC to use PCL and JHU libraries to transform point cloud into meshes

Language: JavaScript - Size: 55.7 MB - Last synced at: about 2 years ago - Pushed at: over 2 years ago - Stars: 13 - Forks: 2

hummat/registration

Registration algorithms (e.g. ICP) for Python with PCL backend.

Language: C++ - Size: 6.41 MB - Last synced at: about 2 years ago - Pushed at: over 3 years ago - Stars: 13 - Forks: 4

adr-arroyo/PointCloudComparator

Trying to compute the completeness of a 3D map and compare it to another 3D map in a pointcloud format

Language: Makefile - Size: 112 MB - Last synced at: over 1 year ago - Pushed at: over 3 years ago - Stars: 12 - Forks: 5

codebydant/pointcloudToTXT

C++ application to convert .ply file or .pcd point cloud into txt format

Language: C++ - Size: 11.7 KB - Last synced at: 7 months ago - Pushed at: over 4 years ago - Stars: 12 - Forks: 4

DevFoundries/WordPressRestApi

WordPressRestApi : A PCL library to access Wordpress content through the v2 API

Language: C# - Size: 411 KB - Last synced at: 5 days ago - Pushed at: almost 8 years ago - Stars: 12 - Forks: 1

jmguerreroh/vision

Material URJC Robotics Software Engineering Degree - Computer Vision. This project contains code examples for Computer Vision using C++ & OpenCV & PCL.

Language: C++ - Size: 80.1 MB - Last synced at: 14 days ago - Pushed at: 14 days ago - Stars: 11 - Forks: 16

Chen-Si-An/Mesh-Reconstruction

Reconstruct mesh from point cloud data generated by 3D scanner

Language: C++ - Size: 61.8 MB - Last synced at: about 1 year ago - Pushed at: almost 2 years ago - Stars: 11 - Forks: 0

prabinrath/dynamicslamtool

Source Code for the DATMO algorithm I developed during my Summer Internship @ University of Calgary

Language: C++ - Size: 1.53 MB - Last synced at: about 2 years ago - Pushed at: over 2 years ago - Stars: 11 - Forks: 5

Husseinhj/NotificationCenter

This library works like Objective-C and Swift NSNotificationCenter. A notification dispatch mechanism that enables the broadcast of information to registered observers.

Language: C# - Size: 1.6 MB - Last synced at: about 5 hours ago - Pushed at: over 6 years ago - Stars: 11 - Forks: 1

yogeshgajjar/SFND_Lidar_Obstacle_Detection

3D LiDAR obstacle detection on point cloud data using segmentation and clustering.

Language: Makefile - Size: 194 MB - Last synced at: about 2 years ago - Pushed at: over 4 years ago - Stars: 9 - Forks: 1

seanngpack/swag-scanner-cpp

A 3D scanning system built from the ground up!

Language: C++ - Size: 4.31 MB - Last synced at: over 1 year ago - Pushed at: over 4 years ago - Stars: 9 - Forks: 2

g0rdan/EpubReader.Cross Fork of vers-one/EpubReader

The port of origin EpubReader library for PCL projects

Language: C# - Size: 549 KB - Last synced at: 7 days ago - Pushed at: over 5 years ago - Stars: 9 - Forks: 1

ryanherman/convertPCLtoCore

17 Steps to Convert your PCL to .NET Standard

Language: C# - Size: 204 KB - Last synced at: about 2 years ago - Pushed at: over 7 years ago - Stars: 9 - Forks: 2

arasgungore/PCL-segmentation-and-tracking

Final project titled "Point Cloud Segmentation and Object Tracking using RGB-D Data" for the Machine Vision (EE 576) course.

Language: C++ - Size: 2.27 MB - Last synced at: 9 days ago - Pushed at: over 1 year ago - Stars: 7 - Forks: 2

codebydant/pcl_visualizer

Visualizer for 3D point cloud using PCL Library 1.9.1

Language: CMake - Size: 662 KB - Last synced at: about 1 month ago - Pushed at: over 2 years ago - Stars: 7 - Forks: 5

ashutoshtiwari13/Hands-on-ROS-botics

Hosts my major and mini Robotics projects 👨‍💻 done as a part of courseware ✍️ and the Robotics NanoDegree 🤖

Size: 18.6 KB - Last synced at: about 1 year ago - Pushed at: over 4 years ago - Stars: 7 - Forks: 0

jmguerreroh/ros2_computer_vision

Material URJC Robotics Software Engineering Degree - Computer Vision. This project contains code examples for Computer Vision using C++ & OpenCV & PCL in ROS2

Language: Python - Size: 203 MB - Last synced at: about 2 years ago - Pushed at: about 2 years ago - Stars: 6 - Forks: 9

austinbhale/PCL-Unreal-4-25-4

PCL integration and dynamic point cloud rendering for Unreal 4.25.4

Language: C++ - Size: 51.3 MB - Last synced at: 14 days ago - Pushed at: about 4 years ago - Stars: 6 - Forks: 1

Dung-Han-Lee/Pointcloud-based-Frontier-Exploration

Pointcloud-based frontier exploration using ROS, PCL and C++.

Language: CMake - Size: 36.1 KB - Last synced at: over 1 year ago - Pushed at: almost 5 years ago - Stars: 6 - Forks: 3

ziqianwenxuan/Machine-vision-inspection-system

QT /C++/Machine vision inspection system

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

leoCamilo/ObjectRecognition

Final paper for conclusion of the course of bachelor of information systems

Language: Roff - Size: 60.6 MB - Last synced at: about 2 years ago - Pushed at: over 6 years ago - Stars: 6 - Forks: 1

tasada038/ros2_rs_pcl

ROS2 sample of Realsense with PCL library

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

amirx96/sign_detection

LIDAR based sign detection program for ROS

Language: CMake - Size: 9.77 KB - Last synced at: about 2 years ago - Pushed at: over 5 years ago - Stars: 5 - Forks: 2

dawan0111/Simple-2D-LiDAR-Odometry

ROS2 humble Simple-2D-LiDAR-Odometry

Language: C++ - Size: 13.7 KB - Last synced at: 12 months ago - Pushed at: 12 months ago - Stars: 4 - Forks: 7

arekmula/articulated_objects_scene_builder

ROS node for estimating a point-cloud-based model of the scene enhanced with information about articulated objects (drawer, wardrobe, cabinet) based on a single RGB-D image.

Language: C++ - Size: 10.9 MB - Last synced at: 9 months ago - Pushed at: almost 4 years ago - Stars: 4 - Forks: 0

olpotkin/Lidar-Obstacle-Detection

Lidar obstacle detection using PCL and C++

Language: C++ - Size: 190 MB - Last synced at: about 2 years ago - Pushed at: almost 5 years ago - Stars: 4 - Forks: 4

WilliamABradley/PlatformBindingsFramework 📦

A Framework for creating code that performs Platform Dependent Tasks in a Generic, OS Independent manner.

Language: C# - Size: 414 KB - Last synced at: 24 days ago - Pushed at: over 6 years ago - Stars: 4 - Forks: 1

TypHo22/PCL_Lidarvisualization

Example how to visualize the sensor data of YLidars-Lidarsensors and visualize it with the PCL-Library

Language: C++ - Size: 221 KB - Last synced at: almost 2 years ago - Pushed at: about 2 years ago - Stars: 3 - Forks: 0

intbot/GitStarsApp

Xamarin Sample app to call GitHub repos real time, along with offline support

Language: C# - Size: 204 KB - Last synced at: about 2 months ago - Pushed at: over 2 years ago - Stars: 3 - Forks: 0

codebydant/pointcloudToPCD

C++ application to convert ply file, txt file or xyz file point cloud to PCD file

Language: C++ - Size: 10.6 MB - Last synced at: 7 months ago - Pushed at: about 4 years ago - Stars: 3 - Forks: 2

codebydant/align_pointcloud

Alignment between the coordinate system of a point cloud and the global coordinate system of pcl

Language: C++ - Size: 534 KB - Last synced at: 7 months ago - Pushed at: over 5 years ago - Stars: 3 - Forks: 3

mgj/fetcher

Network layer for cross-platform apps

Language: C# - Size: 1.75 MB - Last synced at: 3 days ago - Pushed at: about 7 years ago - Stars: 3 - Forks: 0

fisherman6v6/Pcl.NET

PCL (PointCloudLibrary) C# wrapper.

Language: C# - Size: 232 KB - Last synced at: 14 days ago - Pushed at: 14 days ago - Stars: 2 - Forks: 1

jmguerreroh/computer_vision

Material URJC Robotics Software Engineering Degree - Computer Vision. This project contains code examples for Computer Vision using C++ & OpenCV & PCL in ROS 2

Language: C++ - Size: 61.5 KB - Last synced at: about 2 months ago - Pushed at: about 2 months ago - Stars: 2 - Forks: 2

Yan-1999/IA-HeLiC

IMU-assisted Target-free Extrinsic Calibration of Heterogeneous LIDARs Based on Continuous-time Optimization

Language: C++ - Size: 125 KB - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 2 - Forks: 2

ThunderDesign/ThunderDesign.Net-PCL.SQLite

A wrapper around the popular 'sqlite-net-pcl' automating the reading and writing to the database through simple thread-safe bindable objects.

Language: C# - Size: 606 KB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 2 - Forks: 1

jagennath-hari/ros_sfm

A ROS package for Semantic Structure From Motion(SFM) using RGB Image, Depth Map, Camera calibration, Odometry and Semantic Segmentation Network.

Language: C++ - Size: 57.4 MB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 2 - Forks: 2

akgcode/ICP_algorithm

Iterative Closest Point algorithm for fine alignment of point clouds

Language: Makefile - Size: 5.08 MB - Last synced at: over 1 year ago - Pushed at: over 2 years ago - Stars: 2 - Forks: 0

ThunderDesign/ThunderDesign.Xamarin.Forms.FloatingActionButton

FloatingActionButton (FAB) with custom shadow (Color, Offset, Blur) and custom Animation Easing (Show, Hide) for Xamarin.Forms view (Android, iOS, UWP)

Language: C# - Size: 674 KB - Last synced at: over 1 year ago - Pushed at: about 3 years ago - Stars: 2 - Forks: 1

biomotion/baseline_localizer

This repo shows a simple way to utilize pcl:IterativeClosestPoint for localization

Language: C++ - Size: 8.79 KB - Last synced at: about 2 years ago - Pushed at: over 3 years ago - Stars: 2 - Forks: 2

toniortiz/Simple-ICP

Simple ICP usage with PCL library

Language: C++ - Size: 32.2 KB - Last synced at: 4 months ago - Pushed at: over 3 years ago - Stars: 2 - Forks: 1

ken-power/SensorFusionND-UnscentedKalmanFilter

An Unscented Kalman Filter that estimates the state of multiple cars on a highway using noisy lidar and radar measurements.

Language: C++ - Size: 116 MB - Last synced at: about 2 years ago - Pushed at: about 4 years ago - Stars: 2 - Forks: 1

rejoyc-cs/PassThroughFilter

Passthrough Filter in Point Cloud

Language: C++ - Size: 5.86 KB - Last synced at: over 1 year ago - Pushed at: about 4 years ago - Stars: 2 - Forks: 0

yaoli1992/point_cloud_noise_system

this is a example about how to use QT based on PCL 1.7

Language: C++ - Size: 8.2 MB - Last synced at: over 1 year ago - Pushed at: almost 7 years ago - Stars: 2 - Forks: 3

priteshgudge/pick_place_3dperception

Robotics Simulation Project with 3D perception for Pick-Place

Language: C++ - Size: 25 MB - Last synced at: about 2 years ago - Pushed at: over 7 years ago - Stars: 2 - Forks: 1

Tmbao/3DViewExtractor

A script to extract views from 3d mesh using PCL.

Language: C++ - Size: 460 KB - Last synced at: about 2 years ago - Pushed at: about 8 years ago - Stars: 2 - Forks: 0

atharvahude/3D-Vehicle-Time-To-Collision

Track 3D Bounding Boxes and compute Time to Collision

Language: C++ - Size: 2.1 MB - Last synced at: about 1 month ago - Pushed at: 9 months ago - Stars: 1 - Forks: 0

atharvahude/Lidar-Obstacle-Detection

c++ implementation of ransac segmentation, clustering and detection

Language: Makefile - Size: 192 MB - Last synced at: about 1 month ago - Pushed at: 9 months ago - Stars: 1 - Forks: 0

ThunderDesign/ThunderDesign.Net-PCL.Threading

A combination of generic Thread-Safe objects that can be used in all application types.

Language: C# - Size: 828 KB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 1 - Forks: 1

codebydant/iTree3DMap

3D Mapping of a tree for dendrometric feature estimation

Language: C++ - Size: 2.62 MB - Last synced at: 7 months ago - Pushed at: over 2 years ago - Stars: 1 - Forks: 1

codebydant/cloudparse

PCD cloudparse for The Point Cloud Library (PCL)

Language: CMake - Size: 153 KB - Last synced at: 7 months ago - Pushed at: over 2 years ago - Stars: 1 - Forks: 0

ThunderDesign/ThunderDesign.Net-PCL.ToolBox

A set of core methods and classes to ease every days .NET development tasks.

Language: C# - Size: 19.5 KB - Last synced at: over 1 year ago - Pushed at: over 2 years ago - Stars: 1 - Forks: 1

guoxxiong/PointCloud-Points-XML

Pick some points from .pcd files, futher convert these points into an xml file that SUMO can accept.

Language: C++ - Size: 16.6 KB - Last synced at: about 1 year ago - Pushed at: over 2 years ago - Stars: 1 - Forks: 0

Nandite/R2000-Visualizer

R2000 scans visualization using PCL.

Language: C++ - Size: 43 KB - Last synced at: about 1 month ago - Pushed at: almost 3 years ago - Stars: 1 - Forks: 0

ThunderDesign/ThunderDesign.Net-PCL.Dynamic

A combination of generic Dynamic Thread-Safe objects that can be used in all application types.

Language: C# - Size: 389 KB - Last synced at: over 1 year ago - Pushed at: about 3 years ago - Stars: 1 - Forks: 1

ThunderDesign/ThunderDesign.Net-PCL.HttpClientService

A wrapper around 'System.Net.Http.HttpClient' enhancing AutoRedirect and Cookies. Can be used in all application types.

Language: C# - Size: 595 KB - Last synced at: over 1 year ago - Pushed at: about 3 years ago - Stars: 1 - Forks: 1

AgrMayank/PCD-Viewer

Create Point Cloud Prefabs from PCD files.

Language: C# - Size: 3.2 MB - Last synced at: almost 2 years ago - Pushed at: over 3 years ago - Stars: 1 - Forks: 0

dilaragokay/LRF-visualization

Visualization of local reference frames computed with FLARE

Language: C++ - Size: 82 KB - Last synced at: over 1 year ago - Pushed at: almost 4 years ago - Stars: 1 - Forks: 0

PooyaAlamirpour/Lidar-Obstacle-Detection

A self-driving car needs some techniques for preventing collision with pedestrians, vehicles, and other objects that would exist in the way of a car. One of these tools is LiDAR that can be used for obstacle detection on the road. In this repository, I am going to implement a LiDAR Obstacle Detection by using C++.

Language: C++ - Size: 189 MB - Last synced at: about 2 years ago - Pushed at: almost 4 years ago - Stars: 1 - Forks: 0

codebydant/compilingPCL-Linux

This is a tutorial of how to compile PCL 1.11.1 on Ubuntu 20.04.2 LTS

Size: 6.36 MB - Last synced at: 4 months ago - Pushed at: almost 4 years ago - Stars: 1 - Forks: 0

rejoyc-cs/KdTree-PCL

KdTree implemented in Point Cloud

Language: C++ - Size: 2.93 KB - Last synced at: over 1 year ago - Pushed at: about 4 years ago - Stars: 1 - Forks: 0

roncapat/ROS2-HAL-Mesa-SR4xxx-ToF-cameras

ROS2 Hardware Abstraction Layer (HAL) for Mesa Imaging Time of Flight (ToF) cameras SR4000/SR4500

Language: C++ - Size: 20.5 KB - Last synced at: 6 days ago - Pushed at: over 4 years ago - Stars: 1 - Forks: 0

HemaZ/pcl_utils

pcl_utils is a C++ Library for some helpful functions to be used with PCL library.

Language: C++ - Size: 7.47 MB - Last synced at: 5 months ago - Pushed at: over 4 years ago - Stars: 1 - Forks: 0

mibrahimali/SFND_Lidar_Obstacle_Detection

Language: Makefile - Size: 190 MB - Last synced at: over 1 year ago - Pushed at: almost 5 years ago - Stars: 1 - Forks: 0

cmpute/LRansacCalibrator 📦

Lidar and camera calibration using LRANSAC. (Refactoring using C++)

Language: MATLAB - Size: 113 KB - Last synced at: 12 months ago - Pushed at: about 5 years ago - Stars: 1 - Forks: 0

mdleiton/pcl_kinect

Language: C++ - Size: 21.5 MB - Last synced at: 9 months ago - Pushed at: over 5 years ago - Stars: 1 - Forks: 0

brunohjs/3DReconstruction

Recontrução 3D com base em dados de sonar MSIS

Language: Python - Size: 9.23 MB - Last synced at: 5 months ago - Pushed at: over 6 years ago - Stars: 1 - Forks: 0

xmartlabs/docker-pcl-cmake

Docker image containing PCL and CMake.

Size: 5.86 KB - Last synced at: 12 months ago - Pushed at: about 7 years ago - Stars: 1 - Forks: 2

cakirilker/NETStandard

Language: C# - Size: 221 KB - Last synced at: about 2 years ago - Pushed at: over 7 years ago - Stars: 1 - Forks: 0

puma3/Scanner3D

3D Scanner that uses a Laser/light beam projection over an object and a camera to translate bright pixels into dots and linking them to output a 3D mesh.

Language: C++ - Size: 1.47 MB - Last synced at: almost 2 years ago - Pushed at: over 8 years ago - Stars: 1 - Forks: 0

carlosfva1990/libfreenect2pclgrabber Fork of giacomodabisias/libfreenect2pclgrabber

a grabber for the kinect2 which returns a registered pcl point cloud

Size: 10 MB - Last synced at: 9 months ago - Pushed at: over 8 years ago - Stars: 1 - Forks: 0

AnkitaPawar024/SFND_Unscented_Kalman_Filter Fork of udacity/SFND_Unscented_Kalman_Filter

Object tracking with Unscented Kalman filter

Language: C++ - Size: 91.5 MB - Last synced at: 2 months ago - Pushed at: 2 months ago - Stars: 0 - Forks: 0

Alexk1704/mlbot

TurtleBot2 implementation with ROS/PCL

Language: C++ - Size: 1.13 MB - Last synced at: 2 months ago - Pushed at: 2 months ago - Stars: 0 - Forks: 0

AbdullahGM1/l2i_fusion_detection

This ROS2 package integrates data from a 360-degree lidar and a camera to achieve enhanced object tracking through sensor fusion.

Language: C++ - Size: 62.4 MB - Last synced at: 3 months ago - Pushed at: 3 months ago - Stars: 0 - Forks: 3

AbdullahGM1/l2d_detection

Ros2 Package for Using PCL to Convert Point Cloud Data into a Depth Map for Object Detection and Localization

Language: C++ - Size: 45.2 MB - Last synced at: 3 months ago - Pushed at: 3 months ago - Stars: 0 - Forks: 1

SungJaeShin/pose_movement

Publish pose for visualization in rviz using a .csv & .txt & .ply file

Language: C++ - Size: 25.8 MB - Last synced at: 9 months ago - Pushed at: 9 months ago - Stars: 0 - Forks: 0

lidarmansiwon/pcl_cpp

pcl library by siwon, This package is intended for practice and for future use as a tool

Language: CMake - Size: 36.1 KB - Last synced at: 9 months ago - Pushed at: 9 months ago - Stars: 0 - Forks: 0

ALIBDEIRR/Measuring-patterns-from-a-surface-

The follwing work is part of internship project developed by me as a master student in Robotics and Mechatronics.

Language: C++ - Size: 1.39 MB - Last synced at: about 1 month ago - Pushed at: 10 months ago - Stars: 0 - Forks: 0

mucahitayhan/map_visualizer

ROS2 package to visualize .pcd file and .osm file (openstreetmap) and to convert .osm file to occupancy map

Language: C++ - Size: 304 KB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 0

pmdtechnologies/SamplePCL

This tutorial shows how to use different functionalities of the Point Cloud Library (PCL) together with Royale.

Language: C++ - Size: 33.2 KB - Last synced at: over 1 year ago - Pushed at: almost 2 years ago - Stars: 0 - Forks: 0