perception_pcl
perception_pcl copied to clipboard
PCL (Point Cloud Library) ROS interface stack
I'm probably doing something wrong, but I can't figure out what it is. I am using an Intel RealSense R200 to capture a pointcloud. It publishes RGBD data on the...
`PCLNodelet` has a `message_filters::Subscriber` called `sub_input_filter_`. I don't know how, but if the actual topic is a `PointCloud2`, the nodelet can still subscribe to it and gets the message as...
Hi, I'm using the SacSegmentation and ProjectInliers nodelets to find planes. There are times when we want to stop the plane finder for a while (for example by stopping the...
- Need to generate test data (Velodyne, Kinect, etc) - Need to determine where to upload test data - Separate repo? Name? perception_data or perception_test? - https://github.com/blog/1986-announcing-git-large-file-storage-lfs - Generate test...
Need to add some options parsing to improve usability Boost.Program_options or getopt?
user@system:~$ rosrun pcl_ros bag_to_pcd input.bag ./velodyne_points ./pcd Error opening file ./input.bag user@system:~$ rosbag info input.bag ERROR bag unindexed: input.bag. Run rosbag reindex.
Hi folks, I am running in a ROS2 Humble environment a RTABmap node which provides me a topic /rtabmap/cloud_map (sensor_msgs/msg/PointCloud2) and I want it to be exported in a .pcd...
Hi, To incorporate the latest pcl I build pcl from source, and I need to build perception_pcl as well. However, I got this error when running 'make' for **_pcl_ros_**: Traceback...