pcl_ros package from perception_pcl repo

pcl_conversions pcl_ros perception_pcl

Package Summary

Tags No category tags.
Version 2.6.1
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/perception_pcl.git
VCS Type git
VCS Version ros2
Last Updated 2024-04-05
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Steve Macenski
  • Kentaro Wada

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. See repository README.
CHANGELOG

Changelog for package pcl_ros

1.6.2 (2018-05-20)

  • Fix exported includes in Ubuntu Artful
  • Increase limits on CropBox filter parameters
  • Contributors: James Ward, Jiri Horner

1.6.1 (2018-05-08)

  • Add 1.6.0 section to CHANGELOG.rst
  • Fix the use of Eigen3 in cmake
  • Contributors: Kentaro Wada

1.6.0 (2018-04-30)

  • Fix build and update maintainers
  • Add message_filters to find_package
  • Remove unnecessary dependency on genmsg
  • Contributors: Paul Bovbel, Kentaro Wada

1.5.4 (2018-03-31)

  • update to use non deprecated pluginlib macro
  • Fix config path of sample_voxel_grid.launch
  • remove hack now that upstream pcl has been rebuilt
  • Looser hzerror in test for extract_clusters to make it pass on Travis
  • Add sample & test for surface/convex_hull
  • Add sample & test for segmentation/extract_clusters.cpp
  • Add sample & test for io/concatenate_data.cpp
  • Add sample & test for features/normal_3d.cpp
  • Organize samples of pcl_ros/features
  • Add test arg to avoid duplicated testing
  • LazyNodelet for features/*
  • LazyNodelet for filters/ProjectInliers
  • Refactor io/PCDReader and io/PCDWriter as child of PCLNodelet
  • LazyNodelet for io/PointCloudConcatenateFieldsSynchronizer
  • LazyNodelet for io/PointCloudConcatenateDataSynchronizer
  • LazyNodelet for segmentation/SegmentDifferences
  • LazyNodelet for segmentation/SACSegmentationFromNormals
  • LazyNodelet for segmentation/SACSegmentation
  • LazyNodelet for segmentation/ExtractPolygonalPrismData
  • LazyNodelet for segmentation/EuclideanClusterExtraction
  • LazyNodelet for surface/MovingLeastSquares
  • LazyNodelet for surface/ConvexHull2D
  • Add missing COMPONENTS of PCL
  • Inherit NodeletLazy for pipeline with less cpu load
  • Set leaf_size 0.02
  • Install samples
  • Add sample and test for pcl/StatisticalOutlierRemoval Conflicts: pcl_ros/CMakeLists.txt
  • Add sample and test for pcl/VoxelGrid Conflicts: pcl_ros/CMakeLists.txt
  • no need to remove duplicates
  • spourious line change
  • remove now unnecessary build_depend on qtbase5
  • exclude PCL IO libraries exporting Qt flag
  • find only PCL components used instead of all PCL
  • Remove dependency on vtk/libproj-dev (#145) * Remove dependency on vtk/libproj-dev These dependencies were introduced in #124 to temporarily fix missing / wrong dependencies in upstream vtk. This hack is no longer necessary, since fixed vtk packages have been uploaded to packages.ros.org (see #124 and ros-infrastructure/reprepro-updater#32).

    • Remove vtk hack from CMakeLists.txt
  • Contributors: Kentaro Wada, Mikael Arguedas

1.5.3 (2017-05-03)

1.5.2 (2017-04-29)

  • Find Qt5Widgets to fix -lQt5::Widgets error
  • Contributors: Kentaro Wada

1.5.1 (2017-04-26)

  • Add my name as a maintainer
  • Contributors: Kentaro Wada

1.5.0 (2017-04-25)

  • Fix lib name duplication error in ubunt:zesty
  • Detect automatically the version of PCL in cmake
  • Install xml files declaring nodelets
  • Fix syntax of nodelet manifest file by splitting files for each library.
  • Contributors: Kentaro Wada

1.4.0 (2016-04-22)

  • Fixup libproj-dev rosdep
  • Add build depend on libproj, since it\'s not provided by vtk right now
  • manually remove dependency on vtkproj from PCL_LIBRARIES
  • Remove python-vtk for kinetic-devel, see issue #44
  • Contributors: Jackie Kay, Paul Bovbel

1.3.0 (2015-06-22)

  • cleanup broken library links All removed library names are included in \${PCL_LIBRARIES}. However, the plain library names broke catkin\'s overlay mechanism: Where \${PCL_LIBRARIES} could point to a local installation of the PCL, e.g. pcd_ros_segmentation might still link to the system-wide installed version of pcl_segmentation.
  • Fixed test for jade-devel. Progress on #92
  • commented out test_tf_message_filter_pcl Until ros/geometry#80 has been merged the test will fail.
  • fixed indentation and author
  • Adds a test for tf message filters with pcl pointclouds
  • specialized HasHeader, TimeStamp, FrameId

    • HasHeader now returns false

    - TimeStamp and FrameId specialed for pcl::PointCloud<T> for any point type T These changes allow to use pcl::PointCloud with tf::MessageFilter

  • Sync pcl_nodelets.xml from hydro to indigo Fixes to pass catkin lint -W1

  • Fixes #87 for Indigo

  • Fixes #85 for Indigo

  • Fixes #77 and #80 for indigo

  • Added option to save pointclouds in binary and binary compressed format

  • Contributors: Brice Rebsamen, Lucid One, Mitchell Wills, v4hn

1.2.6 (2015-02-04)

1.2.5 (2015-01-20)

1.2.4 (2015-01-15)

1.2.3 (2015-01-10)

  • Update common.py Extended filter limits up to

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged pcl_ros at Robotics Stack Exchange

pcl_ros package from perception_pcl repo

pcl_conversions pcl_ros perception_pcl

Package Summary

Tags No category tags.
Version 2.6.1
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/perception_pcl.git
VCS Type git
VCS Version ros2
Last Updated 2024-04-05
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Steve Macenski
  • Kentaro Wada

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. See repository README.
CHANGELOG

Changelog for package pcl_ros

1.6.2 (2018-05-20)

  • Fix exported includes in Ubuntu Artful
  • Increase limits on CropBox filter parameters
  • Contributors: James Ward, Jiri Horner

1.6.1 (2018-05-08)

  • Add 1.6.0 section to CHANGELOG.rst
  • Fix the use of Eigen3 in cmake
  • Contributors: Kentaro Wada

1.6.0 (2018-04-30)

  • Fix build and update maintainers
  • Add message_filters to find_package
  • Remove unnecessary dependency on genmsg
  • Contributors: Paul Bovbel, Kentaro Wada

1.5.4 (2018-03-31)

  • update to use non deprecated pluginlib macro
  • Fix config path of sample_voxel_grid.launch
  • remove hack now that upstream pcl has been rebuilt
  • Looser hzerror in test for extract_clusters to make it pass on Travis
  • Add sample & test for surface/convex_hull
  • Add sample & test for segmentation/extract_clusters.cpp
  • Add sample & test for io/concatenate_data.cpp
  • Add sample & test for features/normal_3d.cpp
  • Organize samples of pcl_ros/features
  • Add test arg to avoid duplicated testing
  • LazyNodelet for features/*
  • LazyNodelet for filters/ProjectInliers
  • Refactor io/PCDReader and io/PCDWriter as child of PCLNodelet
  • LazyNodelet for io/PointCloudConcatenateFieldsSynchronizer
  • LazyNodelet for io/PointCloudConcatenateDataSynchronizer
  • LazyNodelet for segmentation/SegmentDifferences
  • LazyNodelet for segmentation/SACSegmentationFromNormals
  • LazyNodelet for segmentation/SACSegmentation
  • LazyNodelet for segmentation/ExtractPolygonalPrismData
  • LazyNodelet for segmentation/EuclideanClusterExtraction
  • LazyNodelet for surface/MovingLeastSquares
  • LazyNodelet for surface/ConvexHull2D
  • Add missing COMPONENTS of PCL
  • Inherit NodeletLazy for pipeline with less cpu load
  • Set leaf_size 0.02
  • Install samples
  • Add sample and test for pcl/StatisticalOutlierRemoval Conflicts: pcl_ros/CMakeLists.txt
  • Add sample and test for pcl/VoxelGrid Conflicts: pcl_ros/CMakeLists.txt
  • no need to remove duplicates
  • spourious line change
  • remove now unnecessary build_depend on qtbase5
  • exclude PCL IO libraries exporting Qt flag
  • find only PCL components used instead of all PCL
  • Remove dependency on vtk/libproj-dev (#145) * Remove dependency on vtk/libproj-dev These dependencies were introduced in #124 to temporarily fix missing / wrong dependencies in upstream vtk. This hack is no longer necessary, since fixed vtk packages have been uploaded to packages.ros.org (see #124 and ros-infrastructure/reprepro-updater#32).

    • Remove vtk hack from CMakeLists.txt
  • Contributors: Kentaro Wada, Mikael Arguedas

1.5.3 (2017-05-03)

1.5.2 (2017-04-29)

  • Find Qt5Widgets to fix -lQt5::Widgets error
  • Contributors: Kentaro Wada

1.5.1 (2017-04-26)

  • Add my name as a maintainer
  • Contributors: Kentaro Wada

1.5.0 (2017-04-25)

  • Fix lib name duplication error in ubunt:zesty
  • Detect automatically the version of PCL in cmake
  • Install xml files declaring nodelets
  • Fix syntax of nodelet manifest file by splitting files for each library.
  • Contributors: Kentaro Wada

1.4.0 (2016-04-22)

  • Fixup libproj-dev rosdep
  • Add build depend on libproj, since it\'s not provided by vtk right now
  • manually remove dependency on vtkproj from PCL_LIBRARIES
  • Remove python-vtk for kinetic-devel, see issue #44
  • Contributors: Jackie Kay, Paul Bovbel

1.3.0 (2015-06-22)

  • cleanup broken library links All removed library names are included in \${PCL_LIBRARIES}. However, the plain library names broke catkin\'s overlay mechanism: Where \${PCL_LIBRARIES} could point to a local installation of the PCL, e.g. pcd_ros_segmentation might still link to the system-wide installed version of pcl_segmentation.
  • Fixed test for jade-devel. Progress on #92
  • commented out test_tf_message_filter_pcl Until ros/geometry#80 has been merged the test will fail.
  • fixed indentation and author
  • Adds a test for tf message filters with pcl pointclouds
  • specialized HasHeader, TimeStamp, FrameId

    • HasHeader now returns false

    - TimeStamp and FrameId specialed for pcl::PointCloud<T> for any point type T These changes allow to use pcl::PointCloud with tf::MessageFilter

  • Sync pcl_nodelets.xml from hydro to indigo Fixes to pass catkin lint -W1

  • Fixes #87 for Indigo

  • Fixes #85 for Indigo

  • Fixes #77 and #80 for indigo

  • Added option to save pointclouds in binary and binary compressed format

  • Contributors: Brice Rebsamen, Lucid One, Mitchell Wills, v4hn

1.2.6 (2015-02-04)

1.2.5 (2015-01-20)

1.2.4 (2015-01-15)

1.2.3 (2015-01-10)

  • Update common.py Extended filter limits up to

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged pcl_ros at Robotics Stack Exchange

pcl_ros package from perception_pcl repo

pcl_conversions pcl_ros perception_pcl

Package Summary

Tags No category tags.
Version 2.6.1
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/perception_pcl.git
VCS Type git
VCS Version ros2
Last Updated 2024-04-05
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Steve Macenski
  • Kentaro Wada

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. See repository README.
CHANGELOG

Changelog for package pcl_ros

1.6.2 (2018-05-20)

  • Fix exported includes in Ubuntu Artful
  • Increase limits on CropBox filter parameters
  • Contributors: James Ward, Jiri Horner

1.6.1 (2018-05-08)

  • Add 1.6.0 section to CHANGELOG.rst
  • Fix the use of Eigen3 in cmake
  • Contributors: Kentaro Wada

1.6.0 (2018-04-30)

  • Fix build and update maintainers
  • Add message_filters to find_package
  • Remove unnecessary dependency on genmsg
  • Contributors: Paul Bovbel, Kentaro Wada

1.5.4 (2018-03-31)

  • update to use non deprecated pluginlib macro
  • Fix config path of sample_voxel_grid.launch
  • remove hack now that upstream pcl has been rebuilt
  • Looser hzerror in test for extract_clusters to make it pass on Travis
  • Add sample & test for surface/convex_hull
  • Add sample & test for segmentation/extract_clusters.cpp
  • Add sample & test for io/concatenate_data.cpp
  • Add sample & test for features/normal_3d.cpp
  • Organize samples of pcl_ros/features
  • Add test arg to avoid duplicated testing
  • LazyNodelet for features/*
  • LazyNodelet for filters/ProjectInliers
  • Refactor io/PCDReader and io/PCDWriter as child of PCLNodelet
  • LazyNodelet for io/PointCloudConcatenateFieldsSynchronizer
  • LazyNodelet for io/PointCloudConcatenateDataSynchronizer
  • LazyNodelet for segmentation/SegmentDifferences
  • LazyNodelet for segmentation/SACSegmentationFromNormals
  • LazyNodelet for segmentation/SACSegmentation
  • LazyNodelet for segmentation/ExtractPolygonalPrismData
  • LazyNodelet for segmentation/EuclideanClusterExtraction
  • LazyNodelet for surface/MovingLeastSquares
  • LazyNodelet for surface/ConvexHull2D
  • Add missing COMPONENTS of PCL
  • Inherit NodeletLazy for pipeline with less cpu load
  • Set leaf_size 0.02
  • Install samples
  • Add sample and test for pcl/StatisticalOutlierRemoval Conflicts: pcl_ros/CMakeLists.txt
  • Add sample and test for pcl/VoxelGrid Conflicts: pcl_ros/CMakeLists.txt
  • no need to remove duplicates
  • spourious line change
  • remove now unnecessary build_depend on qtbase5
  • exclude PCL IO libraries exporting Qt flag
  • find only PCL components used instead of all PCL
  • Remove dependency on vtk/libproj-dev (#145) * Remove dependency on vtk/libproj-dev These dependencies were introduced in #124 to temporarily fix missing / wrong dependencies in upstream vtk. This hack is no longer necessary, since fixed vtk packages have been uploaded to packages.ros.org (see #124 and ros-infrastructure/reprepro-updater#32).

    • Remove vtk hack from CMakeLists.txt
  • Contributors: Kentaro Wada, Mikael Arguedas

1.5.3 (2017-05-03)

1.5.2 (2017-04-29)

  • Find Qt5Widgets to fix -lQt5::Widgets error
  • Contributors: Kentaro Wada

1.5.1 (2017-04-26)

  • Add my name as a maintainer
  • Contributors: Kentaro Wada

1.5.0 (2017-04-25)

  • Fix lib name duplication error in ubunt:zesty
  • Detect automatically the version of PCL in cmake
  • Install xml files declaring nodelets
  • Fix syntax of nodelet manifest file by splitting files for each library.
  • Contributors: Kentaro Wada

1.4.0 (2016-04-22)

  • Fixup libproj-dev rosdep
  • Add build depend on libproj, since it\'s not provided by vtk right now
  • manually remove dependency on vtkproj from PCL_LIBRARIES
  • Remove python-vtk for kinetic-devel, see issue #44
  • Contributors: Jackie Kay, Paul Bovbel

1.3.0 (2015-06-22)

  • cleanup broken library links All removed library names are included in \${PCL_LIBRARIES}. However, the plain library names broke catkin\'s overlay mechanism: Where \${PCL_LIBRARIES} could point to a local installation of the PCL, e.g. pcd_ros_segmentation might still link to the system-wide installed version of pcl_segmentation.
  • Fixed test for jade-devel. Progress on #92
  • commented out test_tf_message_filter_pcl Until ros/geometry#80 has been merged the test will fail.
  • fixed indentation and author
  • Adds a test for tf message filters with pcl pointclouds
  • specialized HasHeader, TimeStamp, FrameId

    • HasHeader now returns false

    - TimeStamp and FrameId specialed for pcl::PointCloud<T> for any point type T These changes allow to use pcl::PointCloud with tf::MessageFilter

  • Sync pcl_nodelets.xml from hydro to indigo Fixes to pass catkin lint -W1

  • Fixes #87 for Indigo

  • Fixes #85 for Indigo

  • Fixes #77 and #80 for indigo

  • Added option to save pointclouds in binary and binary compressed format

  • Contributors: Brice Rebsamen, Lucid One, Mitchell Wills, v4hn

1.2.6 (2015-02-04)

1.2.5 (2015-01-20)

1.2.4 (2015-01-15)

1.2.3 (2015-01-10)

  • Update common.py Extended filter limits up to

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged pcl_ros at Robotics Stack Exchange

pcl_ros package from perception_pcl repo

pcl_conversions pcl_ros perception_pcl

Package Summary

Tags No category tags.
Version 1.7.5
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/perception_pcl.git
VCS Type git
VCS Version melodic-devel
Last Updated 2023-02-15
Dev Status MAINTAINED
CI status
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Kentaro Wada
  • Steve Macenski

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. See repository README.
CHANGELOG

Changelog for package pcl_ros

1.7.5 (2023-01-19)

1.7.0 (2019-07-03)

  • Added option for fixed filename (via local parameter) (#102) (cherry picked from commit bd38533523fa5c00f320e6505a2c533e90f9d97e)
  • rewrote pcd_to_pointcloud to publish using a latched topic (#213)
    • pointcloud is published as a latched topic now
    • added functionality: ability to set config via parameters
  • Fix #150: Allow bag_to_pcd to properly respond to topic argument (#215) * Properly respond to topic argument fixing #150 Previously providing a topic name in argv[2], as indicated in the usage string, modified the printouts indicating to the user that they were going to be exporting the correct topic, but the rosbag::View::Query used still grabbed the first sensor_msgs/PointCloud2 topic which was not necessarily what they had specified.

    • Added more useful printouts and type-checking on input topic
  • Catch tf::TransformException in transformPointCloud (#223) * Catch TransformException in transformPointCloud This allows to catch all exceptions, not only tf::LookupException and tf::ExtrapolationException. Note that most of the code using transformPointCloud already (implicitly) assumes this function doesn\'t throw any exception, and they check the return value, which is false when an exception happened (or something went wrong). * Check for transformPointCloud return value In pcl_ros/src/pcl_ros/io/concatenate_data.cpp, which seems to be the only place where that check was missed.

  • Split off pcl_ros_filter into separate library (#239)

  • [Windows][melodic-devel] Fix Boost linkage issue and binary install location. (#238)

    • fix Windows build break. (#6)
    • Fix install path. (#7)
  • Wait for transform in transformPointCloud(). (#214)

  • Added tf2 versions of functions in transforms.h/hpp. (#231)

  • Switch to industrial_ci (#233)

    • Use industrial_ci
    • Run for all melodic target platforms
    • Artful EOL; verbose build and tests
    • Use travis_wait
    • Remove travis_wait
    • Download to devel space
    • Mark SYSTEM includes to avoid spurious warnings
    • Don\'t double-build PRs
  • use <chrono> and <thread> on Windows (#221)

    • Changing from usleep to c++14 style sleep_for for Windows support
  • Contributors: Enrique Fernandez Perdomo, James Xu, Jarvis Schultz, Martin Pecka, Paul Bovbel, Sean Yen, Stefan Kohlbrecher, Wolfgang Merkt, moooeeeep

1.6.2 (2018-05-20)

  • Fix exported includes in Ubuntu Artful
  • Increase limits on CropBox filter parameters
  • Contributors: James Ward, Jiri Horner

1.6.1 (2018-05-08)

  • Add 1.6.0 section to CHANGELOG.rst
  • Fix the use of Eigen3 in cmake
  • Contributors: Kentaro Wada

1.6.0 (2018-04-30)

  • Fix build and update maintainers
  • Add message_filters to find_package
  • Remove unnecessary dependency on genmsg
  • Contributors: Paul Bovbel, Kentaro Wada

1.5.4 (2018-03-31)

  • update to use non deprecated pluginlib macro
  • Fix config path of sample_voxel_grid.launch
  • remove hack now that upstream pcl has been rebuilt
  • Looser hzerror in test for extract_clusters to make it pass on Travis
  • Add sample & test for surface/convex_hull
  • Add sample & test for segmentation/extract_clusters.cpp
  • Add sample & test for io/concatenate_data.cpp
  • Add sample & test for features/normal_3d.cpp
  • Organize samples of pcl_ros/features
  • Add test arg to avoid duplicated testing
  • LazyNodelet for features/*
  • LazyNodelet for filters/ProjectInliers
  • Refactor io/PCDReader and io/PCDWriter as child of PCLNodelet
  • LazyNodelet for io/PointCloudConcatenateFieldsSynchronizer
  • LazyNodelet for io/PointCloudConcatenateDataSynchronizer
  • LazyNodelet for segmentation/SegmentDifferences
  • LazyNodelet for segmentation/SACSegmentationFromNormals
  • LazyNodelet for segmentation/SACSegmentation
  • LazyNodelet for segmentation/ExtractPolygonalPrismData
  • LazyNodelet for segmentation/EuclideanClusterExtraction
  • LazyNodelet for surface/MovingLeastSquares
  • LazyNodelet for surface/ConvexHull2D
  • Add missing COMPONENTS of PCL
  • Inherit NodeletLazy for pipeline with less cpu load
  • Set leaf_size 0.02
  • Install samples
  • Add sample and test for pcl/StatisticalOutlierRemoval Conflicts: pcl_ros/CMakeLists.txt
  • Add sample and test for pcl/VoxelGrid Conflicts: pcl_ros/CMakeLists.txt
  • no need to remove duplicates
  • spourious line change
  • remove now unnecessary build_depend on qtbase5
  • exclude PCL IO libraries exporting Qt flag
  • find only PCL components used instead of all PCL
  • Remove dependency on vtk/libproj-dev (#145) * Remove dependency on vtk/libproj-dev These dependencies were introduced in #124 to temporarily fix missing / wrong dependencies in upstream vtk. This hack is no longer necessary, since fixed vtk packages have been uploaded to packages.ros.org (see #124 and ros-infrastructure/reprepro-updater#32).

    • Remove vtk hack from CMakeLists.txt
  • Contributors: Kentaro Wada, Mikael Arguedas

1.5.3 (2017-05-03)

1.5.2 (2017-04-29)

  • Find Qt5Widgets to fix -lQt5::Widgets error
  • Contributors: Kentaro Wada

1.5.1 (2017-04-26)

  • Add my name as a maintainer
  • Contributors: Kentaro Wada

1.5.0 (2017-04-25)

  • Fix lib name duplication error in ubunt:zesty
  • Detect automatically the version of PCL in cmake
  • Install xml files declaring nodelets
  • Fix syntax of nodelet manifest file by splitting files for each library.
  • Contributors: Kentaro Wada

1.4.0 (2016-04-22)

  • Fixup libproj-dev rosdep
  • Add build depend on libproj, since it\'s not provided by vtk right now
  • manually remove dependency on vtkproj from PCL_LIBRARIES
  • Remove python-vtk for kinetic-devel, see issue #44
  • Contributors: Jackie Kay, Paul Bovbel

1.3.0 (2015-06-22)

  • cleanup broken library links All removed library names are included in \${PCL_LIBRARIES}. However, the plain library names broke catkin\'s overlay mechanism: Where \${PCL_LIBRARIES} could point to a local installation of the PCL, e.g. pcd_ros_segmentation might still link to the system-wide installed version of pcl_segmentation.
  • Fixed test for jade-devel. Progress on #92
  • commented out test_tf_message_filter_pcl Until ros/geometry#80 has been merged the test will fail.
  • fixed indentation and author
  • Adds a test for tf message filters with pcl pointclouds
  • specialized HasHeader, TimeStamp, FrameId

    • HasHeader now returns false

    - TimeStamp and FrameId specialed for pcl::PointCloud<T> for any point type T These changes allow to use pcl::PointCloud with tf::MessageFilter

  • Sync pcl_nodelets.xml from hydro to indigo Fixes to pass catkin lint -W1

  • Fixes #87 for Indigo

  • Fixes #85 for Indigo

  • Fixes #77 and #80 for indigo

  • Added option to save pointclouds in binary and binary compressed format

  • Contributors: Brice Rebsamen, Lucid One, Mitchell Wills, v4hn

1.2.6 (2015-02-04)

1.2.5 (2015-01-20)

1.2.4 (2015-01-15)

1.2.3 (2015-01-10)

  • Update common.py Extended filter limits up to

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
ainstein_radar_filters github-AinsteinAI-ainstein_radar
ainstein_radar_tools github-AinsteinAI-ainstein_radar
basler_tof github-uos-basler_tof
cob_map_accessibility_analysis github-ipa320-cob_navigation
cob_image_flip github-ipa320-cob_perception_common
cob_object_detection_visualizer github-ipa320-cob_perception_common
points_preprocessor github-nobleo-core_perception
ensenso_camera github-ensenso-ros_driver
floam github-flynneva-floam
grid_map_pcl github-anybotics-grid_map
haf_grasping github-davidfischinger-haf_grasping
ira_laser_tools github-iralabdisco-ira_laser_tools
image_view2 github-jsk-ros-pkg-jsk_common
jsk_footstep_planner github-jsk-ros-pkg-jsk_control
jsk_pcl_ros github-jsk-ros-pkg-jsk_recognition
jsk_pcl_ros_utils github-jsk-ros-pkg-jsk_recognition
jsk_perception github-jsk-ros-pkg-jsk_recognition
jsk_recognition_utils github-jsk-ros-pkg-jsk_recognition
mcl_3dl github-at-wat-mcl_3dl
multi_object_tracking_lidar github-praveen-palanisamy-multiple-object-tracking-lidar
nearfield_map github-TUC-ProAut-ros_nearfield_map
safety_limiter github-at-wat-neonavigation
octomap_server github-OctoMap-octomap_mapping
octomap_pa github-TUC-ProAut-ros_octomap
pcdfilter_pa github-tuc-proaut-ros_pcdfilter
perception_pcl github-ros-perception-perception_pcl
pf_driver github-PepperlFuchs-pf_lidar_ros_driver
pr2_tilt_laser_interface github-pr2-pr2_common_actions
pr2_navigation_perception github-PR2-pr2_navigation
pr2_navigation_self_filter github-PR2-pr2_navigation
semantic_point_annotator github-PR2-pr2_navigation
quanergy_client_ros github-QuanergySystems-quanergy_client_ros
robot_self_filter github-pr2-robot_self_filter
rtabmap_odom github-introlab-rtabmap_ros
rtabmap_util github-introlab-rtabmap_ros
laser_ortho_projector github-CCNYRoboticsLab-scan_tools
laser_scan_matcher github-CCNYRoboticsLab-scan_tools
scan_to_cloud_converter github-CCNYRoboticsLab-scan_tools
sciurus17_examples github-rt-net-sciurus17_ros
sciurus17_vision github-rt-net-sciurus17_ros
sick_ldmrs_tools github-SICKAG-sick_ldmrs_laser
sick_scan github-SICKAG-sick_scan
simple_grasping github-mikeferguson-simple_grasping
backward_local_planner github-robosoft-ai-smacc
pure_spinning_local_planner github-robosoft-ai-smacc
undo_path_global_planner github-robosoft-ai-smacc
spatio_temporal_voxel_layer github-SteveMacenski-spatio_temporal_voxel_layer
velo2cam_calibration github-beltransen-velo2cam_calibration
velodyne_pcl github-ros-drivers-velodyne
point_cloud2_filters github-ADVRHumanoids-point_cloud2_filters
sick_visionary_ros github-SICKAG-sick_visionary_ros

Messages

No message files found.

Services

No service files found

Recent questions tagged pcl_ros at Robotics Stack Exchange

pcl_ros package from perception_pcl repo

pcl_conversions pcl_ros perception_pcl

Package Summary

Tags No category tags.
Version 2.1.0
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/perception_pcl.git
VCS Type git
VCS Version eloquent-devel
Last Updated 2020-05-12
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Steve Macenski
  • Kentaro Wada

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. See repository README.
CHANGELOG

Changelog for package pcl_ros

1.6.2 (2018-05-20)

  • Fix exported includes in Ubuntu Artful
  • Increase limits on CropBox filter parameters
  • Contributors: James Ward, Jiri Horner

1.6.1 (2018-05-08)

  • Add 1.6.0 section to CHANGELOG.rst
  • Fix the use of Eigen3 in cmake
  • Contributors: Kentaro Wada

1.6.0 (2018-04-30)

  • Fix build and update maintainers
  • Add message_filters to find_package
  • Remove unnecessary dependency on genmsg
  • Contributors: Paul Bovbel, Kentaro Wada

1.5.4 (2018-03-31)

  • update to use non deprecated pluginlib macro
  • Fix config path of sample_voxel_grid.launch
  • remove hack now that upstream pcl has been rebuilt
  • Looser hzerror in test for extract_clusters to make it pass on Travis
  • Add sample & test for surface/convex_hull
  • Add sample & test for segmentation/extract_clusters.cpp
  • Add sample & test for io/concatenate_data.cpp
  • Add sample & test for features/normal_3d.cpp
  • Organize samples of pcl_ros/features
  • Add test arg to avoid duplicated testing
  • LazyNodelet for features/*
  • LazyNodelet for filters/ProjectInliers
  • Refactor io/PCDReader and io/PCDWriter as child of PCLNodelet
  • LazyNodelet for io/PointCloudConcatenateFieldsSynchronizer
  • LazyNodelet for io/PointCloudConcatenateDataSynchronizer
  • LazyNodelet for segmentation/SegmentDifferences
  • LazyNodelet for segmentation/SACSegmentationFromNormals
  • LazyNodelet for segmentation/SACSegmentation
  • LazyNodelet for segmentation/ExtractPolygonalPrismData
  • LazyNodelet for segmentation/EuclideanClusterExtraction
  • LazyNodelet for surface/MovingLeastSquares
  • LazyNodelet for surface/ConvexHull2D
  • Add missing COMPONENTS of PCL
  • Inherit NodeletLazy for pipeline with less cpu load
  • Set leaf_size 0.02
  • Install samples
  • Add sample and test for pcl/StatisticalOutlierRemoval Conflicts: pcl_ros/CMakeLists.txt
  • Add sample and test for pcl/VoxelGrid Conflicts: pcl_ros/CMakeLists.txt
  • no need to remove duplicates
  • spourious line change
  • remove now unnecessary build_depend on qtbase5
  • exclude PCL IO libraries exporting Qt flag
  • find only PCL components used instead of all PCL
  • Remove dependency on vtk/libproj-dev (#145) * Remove dependency on vtk/libproj-dev These dependencies were introduced in #124 to temporarily fix missing / wrong dependencies in upstream vtk. This hack is no longer necessary, since fixed vtk packages have been uploaded to packages.ros.org (see #124 and ros-infrastructure/reprepro-updater#32).

    • Remove vtk hack from CMakeLists.txt
  • Contributors: Kentaro Wada, Mikael Arguedas

1.5.3 (2017-05-03)

1.5.2 (2017-04-29)

  • Find Qt5Widgets to fix -lQt5::Widgets error
  • Contributors: Kentaro Wada

1.5.1 (2017-04-26)

  • Add my name as a maintainer
  • Contributors: Kentaro Wada

1.5.0 (2017-04-25)

  • Fix lib name duplication error in ubunt:zesty
  • Detect automatically the version of PCL in cmake
  • Install xml files declaring nodelets
  • Fix syntax of nodelet manifest file by splitting files for each library.
  • Contributors: Kentaro Wada

1.4.0 (2016-04-22)

  • Fixup libproj-dev rosdep
  • Add build depend on libproj, since it\'s not provided by vtk right now
  • manually remove dependency on vtkproj from PCL_LIBRARIES
  • Remove python-vtk for kinetic-devel, see issue #44
  • Contributors: Jackie Kay, Paul Bovbel

1.3.0 (2015-06-22)

  • cleanup broken library links All removed library names are included in \${PCL_LIBRARIES}. However, the plain library names broke catkin\'s overlay mechanism: Where \${PCL_LIBRARIES} could point to a local installation of the PCL, e.g. pcd_ros_segmentation might still link to the system-wide installed version of pcl_segmentation.
  • Fixed test for jade-devel. Progress on #92
  • commented out test_tf_message_filter_pcl Until ros/geometry#80 has been merged the test will fail.
  • fixed indentation and author
  • Adds a test for tf message filters with pcl pointclouds
  • specialized HasHeader, TimeStamp, FrameId

    • HasHeader now returns false

    - TimeStamp and FrameId specialed for pcl::PointCloud<T> for any point type T These changes allow to use pcl::PointCloud with tf::MessageFilter

  • Sync pcl_nodelets.xml from hydro to indigo Fixes to pass catkin lint -W1

  • Fixes #87 for Indigo

  • Fixes #85 for Indigo

  • Fixes #77 and #80 for indigo

  • Added option to save pointclouds in binary and binary compressed format

  • Contributors: Brice Rebsamen, Lucid One, Mitchell Wills, v4hn

1.2.6 (2015-02-04)

1.2.5 (2015-01-20)

1.2.4 (2015-01-15)

1.2.3 (2015-01-10)

  • Update common.py Extended filter limits up to

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Messages

No message files found.

Services

No service files found

Recent questions tagged pcl_ros at Robotics Stack Exchange

pcl_ros package from perception_pcl repo

pcl_conversions pcl_ros perception_pcl

Package Summary

Tags No category tags.
Version 2.0.0
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/perception_pcl.git
VCS Type git
VCS Version dashing-devel
Last Updated 2020-02-25
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Steve Macenski
  • Kentaro Wada

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. See repository README.
CHANGELOG

Changelog for package pcl_ros

1.6.2 (2018-05-20)

  • Fix exported includes in Ubuntu Artful
  • Increase limits on CropBox filter parameters
  • Contributors: James Ward, Jiri Horner

1.6.1 (2018-05-08)

  • Add 1.6.0 section to CHANGELOG.rst
  • Fix the use of Eigen3 in cmake
  • Contributors: Kentaro Wada

1.6.0 (2018-04-30)

  • Fix build and update maintainers
  • Add message_filters to find_package
  • Remove unnecessary dependency on genmsg
  • Contributors: Paul Bovbel, Kentaro Wada

1.5.4 (2018-03-31)

  • update to use non deprecated pluginlib macro
  • Fix config path of sample_voxel_grid.launch
  • remove hack now that upstream pcl has been rebuilt
  • Looser hzerror in test for extract_clusters to make it pass on Travis
  • Add sample & test for surface/convex_hull
  • Add sample & test for segmentation/extract_clusters.cpp
  • Add sample & test for io/concatenate_data.cpp
  • Add sample & test for features/normal_3d.cpp
  • Organize samples of pcl_ros/features
  • Add test arg to avoid duplicated testing
  • LazyNodelet for features/*
  • LazyNodelet for filters/ProjectInliers
  • Refactor io/PCDReader and io/PCDWriter as child of PCLNodelet
  • LazyNodelet for io/PointCloudConcatenateFieldsSynchronizer
  • LazyNodelet for io/PointCloudConcatenateDataSynchronizer
  • LazyNodelet for segmentation/SegmentDifferences
  • LazyNodelet for segmentation/SACSegmentationFromNormals
  • LazyNodelet for segmentation/SACSegmentation
  • LazyNodelet for segmentation/ExtractPolygonalPrismData
  • LazyNodelet for segmentation/EuclideanClusterExtraction
  • LazyNodelet for surface/MovingLeastSquares
  • LazyNodelet for surface/ConvexHull2D
  • Add missing COMPONENTS of PCL
  • Inherit NodeletLazy for pipeline with less cpu load
  • Set leaf_size 0.02
  • Install samples
  • Add sample and test for pcl/StatisticalOutlierRemoval Conflicts: pcl_ros/CMakeLists.txt
  • Add sample and test for pcl/VoxelGrid Conflicts: pcl_ros/CMakeLists.txt
  • no need to remove duplicates
  • spourious line change
  • remove now unnecessary build_depend on qtbase5
  • exclude PCL IO libraries exporting Qt flag
  • find only PCL components used instead of all PCL
  • Remove dependency on vtk/libproj-dev (#145) * Remove dependency on vtk/libproj-dev These dependencies were introduced in #124 to temporarily fix missing / wrong dependencies in upstream vtk. This hack is no longer necessary, since fixed vtk packages have been uploaded to packages.ros.org (see #124 and ros-infrastructure/reprepro-updater#32).

    • Remove vtk hack from CMakeLists.txt
  • Contributors: Kentaro Wada, Mikael Arguedas

1.5.3 (2017-05-03)

1.5.2 (2017-04-29)

  • Find Qt5Widgets to fix -lQt5::Widgets error
  • Contributors: Kentaro Wada

1.5.1 (2017-04-26)

  • Add my name as a maintainer
  • Contributors: Kentaro Wada

1.5.0 (2017-04-25)

  • Fix lib name duplication error in ubunt:zesty
  • Detect automatically the version of PCL in cmake
  • Install xml files declaring nodelets
  • Fix syntax of nodelet manifest file by splitting files for each library.
  • Contributors: Kentaro Wada

1.4.0 (2016-04-22)

  • Fixup libproj-dev rosdep
  • Add build depend on libproj, since it\'s not provided by vtk right now
  • manually remove dependency on vtkproj from PCL_LIBRARIES
  • Remove python-vtk for kinetic-devel, see issue #44
  • Contributors: Jackie Kay, Paul Bovbel

1.3.0 (2015-06-22)

  • cleanup broken library links All removed library names are included in \${PCL_LIBRARIES}. However, the plain library names broke catkin\'s overlay mechanism: Where \${PCL_LIBRARIES} could point to a local installation of the PCL, e.g. pcd_ros_segmentation might still link to the system-wide installed version of pcl_segmentation.
  • Fixed test for jade-devel. Progress on #92
  • commented out test_tf_message_filter_pcl Until ros/geometry#80 has been merged the test will fail.
  • fixed indentation and author
  • Adds a test for tf message filters with pcl pointclouds
  • specialized HasHeader, TimeStamp, FrameId

    • HasHeader now returns false

    - TimeStamp and FrameId specialed for pcl::PointCloud<T> for any point type T These changes allow to use pcl::PointCloud with tf::MessageFilter

  • Sync pcl_nodelets.xml from hydro to indigo Fixes to pass catkin lint -W1

  • Fixes #87 for Indigo

  • Fixes #85 for Indigo

  • Fixes #77 and #80 for indigo

  • Added option to save pointclouds in binary and binary compressed format

  • Contributors: Brice Rebsamen, Lucid One, Mitchell Wills, v4hn

1.2.6 (2015-02-04)

1.2.5 (2015-01-20)

1.2.4 (2015-01-15)

1.2.3 (2015-01-10)

  • Update common.py Extended filter limits up to

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Messages

No message files found.

Services

No service files found

Recent questions tagged pcl_ros at Robotics Stack Exchange

pcl_ros package from perception_pcl repo

pcl_conversions pcl_ros perception_pcl

Package Summary

Tags No category tags.
Version 2.2.1
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/perception_pcl.git
VCS Type git
VCS Version foxy-devel
Last Updated 2021-09-14
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Steve Macenski
  • Kentaro Wada

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. See repository README.
CHANGELOG

Changelog for package pcl_ros

1.6.2 (2018-05-20)

  • Fix exported includes in Ubuntu Artful
  • Increase limits on CropBox filter parameters
  • Contributors: James Ward, Jiri Horner

1.6.1 (2018-05-08)

  • Add 1.6.0 section to CHANGELOG.rst
  • Fix the use of Eigen3 in cmake
  • Contributors: Kentaro Wada

1.6.0 (2018-04-30)

  • Fix build and update maintainers
  • Add message_filters to find_package
  • Remove unnecessary dependency on genmsg
  • Contributors: Paul Bovbel, Kentaro Wada

1.5.4 (2018-03-31)

  • update to use non deprecated pluginlib macro
  • Fix config path of sample_voxel_grid.launch
  • remove hack now that upstream pcl has been rebuilt
  • Looser hzerror in test for extract_clusters to make it pass on Travis
  • Add sample & test for surface/convex_hull
  • Add sample & test for segmentation/extract_clusters.cpp
  • Add sample & test for io/concatenate_data.cpp
  • Add sample & test for features/normal_3d.cpp
  • Organize samples of pcl_ros/features
  • Add test arg to avoid duplicated testing
  • LazyNodelet for features/*
  • LazyNodelet for filters/ProjectInliers
  • Refactor io/PCDReader and io/PCDWriter as child of PCLNodelet
  • LazyNodelet for io/PointCloudConcatenateFieldsSynchronizer
  • LazyNodelet for io/PointCloudConcatenateDataSynchronizer
  • LazyNodelet for segmentation/SegmentDifferences
  • LazyNodelet for segmentation/SACSegmentationFromNormals
  • LazyNodelet for segmentation/SACSegmentation
  • LazyNodelet for segmentation/ExtractPolygonalPrismData
  • LazyNodelet for segmentation/EuclideanClusterExtraction
  • LazyNodelet for surface/MovingLeastSquares
  • LazyNodelet for surface/ConvexHull2D
  • Add missing COMPONENTS of PCL
  • Inherit NodeletLazy for pipeline with less cpu load
  • Set leaf_size 0.02
  • Install samples
  • Add sample and test for pcl/StatisticalOutlierRemoval Conflicts: pcl_ros/CMakeLists.txt
  • Add sample and test for pcl/VoxelGrid Conflicts: pcl_ros/CMakeLists.txt
  • no need to remove duplicates
  • spourious line change
  • remove now unnecessary build_depend on qtbase5
  • exclude PCL IO libraries exporting Qt flag
  • find only PCL components used instead of all PCL
  • Remove dependency on vtk/libproj-dev (#145) * Remove dependency on vtk/libproj-dev These dependencies were introduced in #124 to temporarily fix missing / wrong dependencies in upstream vtk. This hack is no longer necessary, since fixed vtk packages have been uploaded to packages.ros.org (see #124 and ros-infrastructure/reprepro-updater#32).

    • Remove vtk hack from CMakeLists.txt
  • Contributors: Kentaro Wada, Mikael Arguedas

1.5.3 (2017-05-03)

1.5.2 (2017-04-29)

  • Find Qt5Widgets to fix -lQt5::Widgets error
  • Contributors: Kentaro Wada

1.5.1 (2017-04-26)

  • Add my name as a maintainer
  • Contributors: Kentaro Wada

1.5.0 (2017-04-25)

  • Fix lib name duplication error in ubunt:zesty
  • Detect automatically the version of PCL in cmake
  • Install xml files declaring nodelets
  • Fix syntax of nodelet manifest file by splitting files for each library.
  • Contributors: Kentaro Wada

1.4.0 (2016-04-22)

  • Fixup libproj-dev rosdep
  • Add build depend on libproj, since it\'s not provided by vtk right now
  • manually remove dependency on vtkproj from PCL_LIBRARIES
  • Remove python-vtk for kinetic-devel, see issue #44
  • Contributors: Jackie Kay, Paul Bovbel

1.3.0 (2015-06-22)

  • cleanup broken library links All removed library names are included in \${PCL_LIBRARIES}. However, the plain library names broke catkin\'s overlay mechanism: Where \${PCL_LIBRARIES} could point to a local installation of the PCL, e.g. pcd_ros_segmentation might still link to the system-wide installed version of pcl_segmentation.
  • Fixed test for jade-devel. Progress on #92
  • commented out test_tf_message_filter_pcl Until ros/geometry#80 has been merged the test will fail.
  • fixed indentation and author
  • Adds a test for tf message filters with pcl pointclouds
  • specialized HasHeader, TimeStamp, FrameId

    • HasHeader now returns false

    - TimeStamp and FrameId specialed for pcl::PointCloud<T> for any point type T These changes allow to use pcl::PointCloud with tf::MessageFilter

  • Sync pcl_nodelets.xml from hydro to indigo Fixes to pass catkin lint -W1

  • Fixes #87 for Indigo

  • Fixes #85 for Indigo

  • Fixes #77 and #80 for indigo

  • Added option to save pointclouds in binary and binary compressed format

  • Contributors: Brice Rebsamen, Lucid One, Mitchell Wills, v4hn

1.2.6 (2015-02-04)

1.2.5 (2015-01-20)

1.2.4 (2015-01-15)

1.2.3 (2015-01-10)

  • Update common.py Extended filter limits up to

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged pcl_ros at Robotics Stack Exchange

pcl_ros package from perception_pcl repo

pcl_conversions pcl_ros perception_pcl

Package Summary

Tags No category tags.
Version 2.2.1
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/perception_pcl.git
VCS Type git
VCS Version foxy-devel
Last Updated 2021-09-14
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Steve Macenski
  • Kentaro Wada

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. See repository README.
CHANGELOG

Changelog for package pcl_ros

1.6.2 (2018-05-20)

  • Fix exported includes in Ubuntu Artful
  • Increase limits on CropBox filter parameters
  • Contributors: James Ward, Jiri Horner

1.6.1 (2018-05-08)

  • Add 1.6.0 section to CHANGELOG.rst
  • Fix the use of Eigen3 in cmake
  • Contributors: Kentaro Wada

1.6.0 (2018-04-30)

  • Fix build and update maintainers
  • Add message_filters to find_package
  • Remove unnecessary dependency on genmsg
  • Contributors: Paul Bovbel, Kentaro Wada

1.5.4 (2018-03-31)

  • update to use non deprecated pluginlib macro
  • Fix config path of sample_voxel_grid.launch
  • remove hack now that upstream pcl has been rebuilt
  • Looser hzerror in test for extract_clusters to make it pass on Travis
  • Add sample & test for surface/convex_hull
  • Add sample & test for segmentation/extract_clusters.cpp
  • Add sample & test for io/concatenate_data.cpp
  • Add sample & test for features/normal_3d.cpp
  • Organize samples of pcl_ros/features
  • Add test arg to avoid duplicated testing
  • LazyNodelet for features/*
  • LazyNodelet for filters/ProjectInliers
  • Refactor io/PCDReader and io/PCDWriter as child of PCLNodelet
  • LazyNodelet for io/PointCloudConcatenateFieldsSynchronizer
  • LazyNodelet for io/PointCloudConcatenateDataSynchronizer
  • LazyNodelet for segmentation/SegmentDifferences
  • LazyNodelet for segmentation/SACSegmentationFromNormals
  • LazyNodelet for segmentation/SACSegmentation
  • LazyNodelet for segmentation/ExtractPolygonalPrismData
  • LazyNodelet for segmentation/EuclideanClusterExtraction
  • LazyNodelet for surface/MovingLeastSquares
  • LazyNodelet for surface/ConvexHull2D
  • Add missing COMPONENTS of PCL
  • Inherit NodeletLazy for pipeline with less cpu load
  • Set leaf_size 0.02
  • Install samples
  • Add sample and test for pcl/StatisticalOutlierRemoval Conflicts: pcl_ros/CMakeLists.txt
  • Add sample and test for pcl/VoxelGrid Conflicts: pcl_ros/CMakeLists.txt
  • no need to remove duplicates
  • spourious line change
  • remove now unnecessary build_depend on qtbase5
  • exclude PCL IO libraries exporting Qt flag
  • find only PCL components used instead of all PCL
  • Remove dependency on vtk/libproj-dev (#145) * Remove dependency on vtk/libproj-dev These dependencies were introduced in #124 to temporarily fix missing / wrong dependencies in upstream vtk. This hack is no longer necessary, since fixed vtk packages have been uploaded to packages.ros.org (see #124 and ros-infrastructure/reprepro-updater#32).

    • Remove vtk hack from CMakeLists.txt
  • Contributors: Kentaro Wada, Mikael Arguedas

1.5.3 (2017-05-03)

1.5.2 (2017-04-29)

  • Find Qt5Widgets to fix -lQt5::Widgets error
  • Contributors: Kentaro Wada

1.5.1 (2017-04-26)

  • Add my name as a maintainer
  • Contributors: Kentaro Wada

1.5.0 (2017-04-25)

  • Fix lib name duplication error in ubunt:zesty
  • Detect automatically the version of PCL in cmake
  • Install xml files declaring nodelets
  • Fix syntax of nodelet manifest file by splitting files for each library.
  • Contributors: Kentaro Wada

1.4.0 (2016-04-22)

  • Fixup libproj-dev rosdep
  • Add build depend on libproj, since it\'s not provided by vtk right now
  • manually remove dependency on vtkproj from PCL_LIBRARIES
  • Remove python-vtk for kinetic-devel, see issue #44
  • Contributors: Jackie Kay, Paul Bovbel

1.3.0 (2015-06-22)

  • cleanup broken library links All removed library names are included in \${PCL_LIBRARIES}. However, the plain library names broke catkin\'s overlay mechanism: Where \${PCL_LIBRARIES} could point to a local installation of the PCL, e.g. pcd_ros_segmentation might still link to the system-wide installed version of pcl_segmentation.
  • Fixed test for jade-devel. Progress on #92
  • commented out test_tf_message_filter_pcl Until ros/geometry#80 has been merged the test will fail.
  • fixed indentation and author
  • Adds a test for tf message filters with pcl pointclouds
  • specialized HasHeader, TimeStamp, FrameId

    • HasHeader now returns false

    - TimeStamp and FrameId specialed for pcl::PointCloud<T> for any point type T These changes allow to use pcl::PointCloud with tf::MessageFilter

  • Sync pcl_nodelets.xml from hydro to indigo Fixes to pass catkin lint -W1

  • Fixes #87 for Indigo

  • Fixes #85 for Indigo

  • Fixes #77 and #80 for indigo

  • Added option to save pointclouds in binary and binary compressed format

  • Contributors: Brice Rebsamen, Lucid One, Mitchell Wills, v4hn

1.2.6 (2015-02-04)

1.2.5 (2015-01-20)

1.2.4 (2015-01-15)

1.2.3 (2015-01-10)

  • Update common.py Extended filter limits up to

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged pcl_ros at Robotics Stack Exchange

pcl_ros package from perception_pcl repo

pcl_ros perception_pcl

Package Summary

Tags No category tags.
Version 1.5.4
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/perception_pcl.git
VCS Type git
VCS Version lunar-devel
Last Updated 2018-04-25
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Bill Morris
  • Kentaro Wada

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. See repository README.
CHANGELOG

Changelog for package pcl_ros

1.5.4 (2018-03-31)

  • update to use non deprecated pluginlib macro
  • Fix config path of sample_voxel_grid.launch
  • remove hack now that upstream pcl has been rebuilt
  • Looser hzerror in test for extract_clusters to make it pass on Travis
  • Add sample & test for surface/convex_hull
  • Add sample & test for segmentation/extract_clusters.cpp
  • Add sample & test for io/concatenate_data.cpp
  • Add sample & test for features/normal_3d.cpp
  • Organize samples of pcl_ros/features
  • Add test arg to avoid duplicated testing
  • LazyNodelet for features/*
  • LazyNodelet for filters/ProjectInliers
  • Refactor io/PCDReader and io/PCDWriter as child of PCLNodelet
  • LazyNodelet for io/PointCloudConcatenateFieldsSynchronizer
  • LazyNodelet for io/PointCloudConcatenateDataSynchronizer
  • LazyNodelet for segmentation/SegmentDifferences
  • LazyNodelet for segmentation/SACSegmentationFromNormals
  • LazyNodelet for segmentation/SACSegmentation
  • LazyNodelet for segmentation/ExtractPolygonalPrismData
  • LazyNodelet for segmentation/EuclideanClusterExtraction
  • LazyNodelet for surface/MovingLeastSquares
  • LazyNodelet for surface/ConvexHull2D
  • Add missing COMPONENTS of PCL
  • Inherit NodeletLazy for pipeline with less cpu load
  • Set leaf_size 0.02
  • Install samples
  • Add sample and test for pcl/StatisticalOutlierRemoval Conflicts: pcl_ros/CMakeLists.txt
  • Add sample and test for pcl/VoxelGrid Conflicts: pcl_ros/CMakeLists.txt
  • no need to remove duplicates
  • spourious line change
  • remove now unnecessary build_depend on qtbase5
  • exclude PCL IO libraries exporting Qt flag
  • find only PCL components used instead of all PCL
  • Remove dependency on vtk/libproj-dev (#145) * Remove dependency on vtk/libproj-dev These dependencies were introduced in #124 to temporarily fix missing / wrong dependencies in upstream vtk. This hack is no longer necessary, since fixed vtk packages have been uploaded to packages.ros.org (see #124 and ros-infrastructure/reprepro-updater#32).

    • Remove vtk hack from CMakeLists.txt
  • Contributors: Kentaro Wada, Mikael Arguedas

1.5.3 (2017-05-03)

1.5.2 (2017-04-29)

  • Find Qt5Widgets to fix -lQt5::Widgets error
  • Contributors: Kentaro Wada

1.5.1 (2017-04-26)

  • Add my name as a maintainer
  • Contributors: Kentaro Wada

1.5.0 (2017-04-25)

  • Fix lib name duplication error in ubunt:zesty
  • Detect automatically the version of PCL in cmake
  • Install xml files declaring nodelets
  • Fix syntax of nodelet manifest file by splitting files for each library.
  • Contributors: Kentaro Wada

1.4.0 (2016-04-22)

  • Fixup libproj-dev rosdep
  • Add build depend on libproj, since it\'s not provided by vtk right now
  • manually remove dependency on vtkproj from PCL_LIBRARIES
  • Remove python-vtk for kinetic-devel, see issue #44
  • Contributors: Jackie Kay, Paul Bovbel

1.3.0 (2015-06-22)

  • cleanup broken library links All removed library names are included in \${PCL_LIBRARIES}. However, the plain library names broke catkin\'s overlay mechanism: Where \${PCL_LIBRARIES} could point to a local installation of the PCL, e.g. pcd_ros_segmentation might still link to the system-wide installed version of pcl_segmentation.
  • Fixed test for jade-devel. Progress on #92
  • commented out test_tf_message_filter_pcl Until ros/geometry#80 has been merged the test will fail.
  • fixed indentation and author
  • Adds a test for tf message filters with pcl pointclouds
  • specialized HasHeader, TimeStamp, FrameId

    • HasHeader now returns false

    - TimeStamp and FrameId specialed for pcl::PointCloud<T> for any point type T These changes allow to use pcl::PointCloud with tf::MessageFilter

  • Sync pcl_nodelets.xml from hydro to indigo Fixes to pass catkin lint -W1

  • Fixes #87 for Indigo

  • Fixes #85 for Indigo

  • Fixes #77 and #80 for indigo

  • Added option to save pointclouds in binary and binary compressed format

  • Contributors: Brice Rebsamen, Lucid One, Mitchell Wills, v4hn

1.2.6 (2015-02-04)

1.2.5 (2015-01-20)

1.2.4 (2015-01-15)

1.2.3 (2015-01-10)

  • Update common.py Extended filter limits up to

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Messages

No message files found.

Services

No service files found

Recent questions tagged pcl_ros at Robotics Stack Exchange

pcl_ros package from perception_pcl repo

pcl_ros perception_pcl

Package Summary

Tags No category tags.
Version 1.3.0
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/perception_pcl.git
VCS Type git
VCS Version jade-devel
Last Updated 2019-07-03
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Bill Morris

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. No README in repository either.
CHANGELOG

Changelog for package pcl_ros

1.3.0 (2015-06-22)

  • cleanup broken library links All removed library names are included in \${PCL_LIBRARIES}. However, the plain library names broke catkin\'s overlay mechanism: Where \${PCL_LIBRARIES} could point to a local installation of the PCL, e.g. pcd_ros_segmentation might still link to the system-wide installed version of pcl_segmentation.
  • Fixed test for jade-devel. Progress on #92
  • commented out test_tf_message_filter_pcl Until ros/geometry#80 has been merged the test will fail.
  • fixed indentation and author
  • Adds a test for tf message filters with pcl pointclouds
  • specialized HasHeader, TimeStamp, FrameId

    • HasHeader now returns false

    - TimeStamp and FrameId specialed for pcl::PointCloud<T> for any point type T These changes allow to use pcl::PointCloud with tf::MessageFilter

  • Sync pcl_nodelets.xml from hydro to indigo Fixes to pass catkin lint -W1

  • Fixes #87 for Indigo

  • Fixes #85 for Indigo

  • Fixes #77 and #80 for indigo

  • Added option to save pointclouds in binary and binary compressed format

  • Contributors: Brice Rebsamen, Lucid One, Mitchell Wills, v4hn

1.2.6 (2015-02-04)

1.2.5 (2015-01-20)

1.2.4 (2015-01-15)

1.2.3 (2015-01-10)

  • Update common.py Extended filter limits up to

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
ar_track_alvar github-ros-perception-ar_track_alvar
basler_tof github-uos-basler_tof
bta_tof_driver github-voxel-dot-at-bta_tof_driver
depthcloud_encoder github-RobotWebTools-depthcloud_encoder
grid_map_pcl github-ethz-asl-grid_map
haf_grasping github-davidfischinger-haf_grasping
image_view2 github-jsk-ros-pkg-jsk_common
jsk_footstep_planner github-jsk-ros-pkg-jsk_control
jsk_pcl_ros github-jsk-ros-pkg-jsk_recognition
jsk_pcl_ros_utils github-jsk-ros-pkg-jsk_recognition
jsk_perception github-jsk-ros-pkg-jsk_recognition
jsk_recognition_utils github-jsk-ros-pkg-jsk_recognition
base_local_planner github-ros-planning-navigation
costmap_2d github-ros-planning-navigation
navfn github-ros-planning-navigation
octomap_server github-OctoMap-octomap_mapping
pcdfilter_pa github-peterweissig-ros_pcdfilter
perception_pcl github-ros-perception-perception_pcl
robot_self_filter github-pr2-robot_self_filter
rtabmap_ros github-introlab-rtabmap_ros
laser_ortho_projector github-ccny-ros-pkg-scan_tools
laser_scan_matcher github-ccny-ros-pkg-scan_tools
scan_to_cloud_converter github-ccny-ros-pkg-scan_tools
sick_ldmrs_tools github-SICKAG-sick_ldmrs_laser
uwsim github-uji-ros-pkg-underwater_simulation
hector_costmap github-tu-darmstadt-ros-pkg-hector_navigation
hector_elevation_mapping github-tu-darmstadt-ros-pkg-hector_navigation
hector_soft_obstacle_detection github-tu-darmstadt-ros-pkg-hector_vision
hector_thermal_self_filter github-tu-darmstadt-ros-pkg-hector_vision
hector_barrel_detection_nodelet github-tu-darmstadt-ros-pkg-hector_visualization
hector_barrel_geotiff_plugin github-tu-darmstadt-ros-pkg-hector_visualization
object_recognition_transparent_objects github-wg-perception-transparent_objects
bta_ros github-voxel-dot-at-bta_ros
head_pose_estimation github-OSUrobotics-ros-head-tracking
stereo_slam github-srv-stereo_slam
rail_recognition github-GT-RAIL-rail_pick_and_place
stream_manipulator_3d github-3DVision-Stack-stream-manipulator-3D

Messages

No message files found.

Services

No service files found

Plugins

Recent questions tagged pcl_ros at Robotics Stack Exchange

pcl_ros package from perception_pcl repo

pcl_ros perception_pcl

Package Summary

Tags No category tags.
Version 1.2.9
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/perception_pcl.git
VCS Type git
VCS Version indigo-devel
Last Updated 2018-04-03
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Bill Morris

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. No README in repository either.
CHANGELOG

Changelog for package pcl_ros

1.2.9 (2018-04-04)

1.2.8 (2018-04-03)

1.2.7 (2015-06-08)

  • Sync pcl_nodelets.xml from hydro to indigo Fixes to pass catkin lint -W1
  • Fixes #87 for Indigo
  • Fixes #85 for Indigo
  • Fixes #77 and #80 for indigo
  • Added option to save pointclouds in binary and binary compressed format
  • Contributors: Lucid One, Mitchell Wills

1.2.6 (2015-02-04)

1.2.5 (2015-01-20)

1.2.4 (2015-01-15)

1.2.3 (2015-01-10)

  • Update common.py Extended filter limits up to

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
ar_track_alvar github-ros-perception-ar_track_alvar
asr_descriptor_surface_based_recognition github-asr-ros-asr_descriptor_surface_based_recognition
asr_navfn github-asr-ros-asr_navfn
basler_tof github-uos-basler_tof
bta_tof_driver github-voxel-dot-at-bta_tof_driver
cob_map_accessibility_analysis github-ipa320-cob_navigation
cob_image_flip github-ipa320-cob_perception_common
cob_object_detection_visualizer github-ipa320-cob_perception_common
depthcloud_encoder github-RobotWebTools-depthcloud_encoder
grid_map_pcl github-anybotics-grid_map
haf_grasping github-davidfischinger-haf_grasping
ibeo_lux github-astuff-ibeo_lux
image_view2 github-jsk-ros-pkg-jsk_common
jsk_footstep_planner github-jsk-ros-pkg-jsk_control
jsk_pcl_ros github-jsk-ros-pkg-jsk_recognition
jsk_pcl_ros_utils github-jsk-ros-pkg-jsk_recognition
jsk_perception github-jsk-ros-pkg-jsk_recognition
jsk_recognition_utils github-jsk-ros-pkg-jsk_recognition
mcl_3dl github-at-wat-mcl_3dl
multi_object_tracking_lidar github-praveen-palanisamy-multiple-object-tracking-lidar
base_local_planner github-ros-planning-navigation
costmap_2d github-ros-planning-navigation
navfn github-ros-planning-navigation
map_organizer github-at-wat-neonavigation
obj_to_pointcloud github-at-wat-neonavigation
safety_limiter github-at-wat-neonavigation
octomap_server github-OctoMap-octomap_mapping
octomap_pa github-TUC-ProAut-ros_octomap
pcdfilter_pa github-tuc-proaut-ros_pcdfilter
perception_pcl github-ros-perception-perception_pcl
pr2_tilt_laser_interface github-pr2-pr2_common_actions
pr2_navigation_perception github-pr2-pr2_navigation
pr2_navigation_self_filter github-pr2-pr2_navigation
semantic_point_annotator github-pr2-pr2_navigation
rc_cloud_accumulator github-roboception-rc_cloud_accumulator
robot_self_filter github-pr2-robot_self_filter
rtabmap_ros github-introlab-rtabmap_ros
laser_ortho_projector github-ccny-ros-pkg-scan_tools
laser_scan_matcher github-ccny-ros-pkg-scan_tools
scan_to_cloud_converter github-ccny-ros-pkg-scan_tools
sick_ldmrs_tools github-SICKAG-sick_ldmrs_laser
sick_scan github-SICKAG-sick_scan
uwsim github-uji-ros-pkg-underwater_simulation
velodyne_pcl github-ros-drivers-velodyne
depth_sensor_pose github-mdrwiega-depth_nav_tools
hector_costmap github-tu-darmstadt-ros-pkg-hector_navigation
hector_elevation_mapping github-tu-darmstadt-ros-pkg-hector_navigation
hector_soft_obstacle_detection github-tu-darmstadt-ros-pkg-hector_vision
hector_thermal_self_filter github-tu-darmstadt-ros-pkg-hector_vision
hector_barrel_detection_nodelet github-tu-darmstadt-ros-pkg-hector_visualization
hector_barrel_geotiff_plugin github-tu-darmstadt-ros-pkg-hector_visualization
humanoid_localization github-AravindaDP-humanoid_navigation
industrial_extrinsic_cal github-ros-industrial-industrial_calibration
rgbd_depth_correction github-ros-industrial-industrial_calibration
object_recognition_transparent_objects github-wg-perception-transparent_objects
oculusprime github-xaxxontech-oculusprime_ros
feature_tracker github-tu-rbo-omip
joint_tracker github-tu-rbo-omip
omip_common github-tu-rbo-omip
rb_tracker github-tu-rbo-omip
shape_reconstruction github-tu-rbo-omip
shape_tracker github-tu-rbo-omip
phoxi_camera github-photoneo-phoxi_camera
pointcloud_tools github-srv-srv_tools
turtlebot_arm_block_manipulation github-turtlebot-turtlebot_arm
turtlebot_arm_kinect_calibration github-turtlebot-turtlebot_arm
argos3d_p100 github-voxel-dot-at-argos3d_p100_ros_pkg
bta_ros github-voxel-dot-at-bta_ros
bwi_scavenger github-utexas-bwi-bwi_common
cob_openni2_tracker github-ipa-rmb-cob_people_perception
cob_people_detection github-ipa-rmb-cob_people_perception
head_pose_estimation github-OSUrobotics-ros-head-tracking
segbot_sensors github-utexas-bwi-segbot
sentis_tof_m100 github-voxel-dot-at-sentis_tof_m100_pkg
softkinetic_camera github-ipa320-softkinetic
stereo_slam github-srv-stereo_slam
velodyne_height_map github-jack-oquin-velodyne_height_map
viso2_ros github-srv-viso2
camera_pose_calibration github-delftrobotics-camera_pose_calibration
carl_moveit github-GT-RAIL-carl_moveit
custom_landmark_2d github-matthew-liu-custom_landmark_2d
pointcloud2pcd github-ZhuangYanDLUT-dlut_laser
dlut_viso2_ros github-ZhuangYanDLUT-dlut_vision
ekf_localization github-vislab-tecnico-lisboa-ekf_localization
fetch_pbd_interaction github-fetchrobotics-fetch_pbd
hexagon_map github-DS921020-hexagon_map
point_cloud_reducer github-CIR-KIT-human_detector
industrial_collision_detection github-ros-industrial-industrial_moveit
jsk_apc2016_common github-start-jsk-jsk_apc
micros_dynamic_objects_filter github-yincanben-micros_dynamic_objects_filter
o3d3xx github-lovepark-o3d3xx-ros
orsens github-Oriense-orsens_ros
rail_recognition github-GT-RAIL-rail_pick_and_place
rapid_pbd github-jstnhuang-rapid_pbd
remote_manipulation_markers github-GT-RAIL-remote_manipulation_markers
rgbdslam github-felixendres-rgbdslam_v2
slam6d_exporter github-uos-slam6d_exporter
spin_hokuyo github-RobustFieldAutonomyLab-spin_hokuyo
stream_manipulator_3d github-3DVision-Stack-stream-manipulator-3D
octomap_tensor_field github-zlt1991-tensor_field_nav
tinkerforge_laser_transform github-gus484-ros
turtlebot_exploration_3d github-RobustFieldAutonomyLab-turtlebot_exploration_3d

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Recent questions tagged pcl_ros at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.1.11
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/perception_pcl.git
VCS Type git
VCS Version hydro-devel
Last Updated 2015-05-26
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Bill Morris

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. No README in repository either.
CHANGELOG

Changelog for package pcl_ros

1.1.11 (2015-01-10)

1.1.10 (2014-10-25)

1.1.9 (2014-09-13)

  • Created a nodelet for the CropBox filter
  • Tests no longer exist
  • add nodelet definitions to xml
  • Contributors: Mart

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
ar_track_alvar github-sniekum-ar_track_alvar
cob_image_flip github-ipa320-cob_perception_common
depthcloud_encoder github-RobotWebTools-depthcloud_encoder
depth_image_proc github-ros-perception-image_pipeline
image_view2 github-jsk-ros-pkg-jsk_common
jsk_footstep_planner github-jsk-ros-pkg-jsk_control
jsk_pcl_ros github-jsk-ros-pkg-jsk_recognition
jsk_pcl_ros_utils github-jsk-ros-pkg-jsk_recognition
jsk_perception github-jsk-ros-pkg-jsk_recognition
jsk_recognition_utils github-jsk-ros-pkg-jsk_recognition
base_local_planner github-ros-planning-navigation
costmap_2d github-ros-planning-navigation
navfn github-ros-planning-navigation
octomap_server github-OctoMap-octomap_mapping
octomap_ros github-OctoMap-octomap_ros
perception_pcl github-ros-perception-perception_pcl
pointcloud_to_laserscan github-ros-perception-perception_pcl
pr2_tilt_laser_interface github-pr2-pr2_common_actions
pr2_navigation_perception github-pr2-pr2_navigation
pr2_navigation_self_filter github-pr2-pr2_navigation
semantic_point_annotator github-pr2-pr2_navigation
rtabmap_ros github-introlab-rtabmap_ros
velodyne_pcl github-ros-drivers-velodyne
handle_detector github-atenpas-handle_detector
hector_costmap github-tu-darmstadt-ros-pkg-hector_navigation
hector_elevation_mapping github-tu-darmstadt-ros-pkg-hector_navigation
hector_soft_obstacle_detection github-tu-darmstadt-ros-pkg-hector_vision
hector_thermal_self_filter github-tu-darmstadt-ros-pkg-hector_vision
hector_barrel_detection_nodelet github-tu-darmstadt-ros-pkg-hector_visualization
hector_barrel_geotiff_plugin github-tu-darmstadt-ros-pkg-hector_visualization
humanoid_localization github-ahornung-humanoid_navigation
object_recognition_transparent_objects github-wg-perception-transparent_objects
pointcloud_tools github-srv-srv_tools
turtlebot_follower github-turtlebot-turtlebot_apps
ar_kinect github-mikeferguson-ar_kinect
argos3d_p100 github-voxel-dot-at-argos3d_p100_ros_pkg
bta_ros github-voxel-dot-at-bta_ros
cob_3d_features github-ipa320-cob_environment_perception
cob_3d_mapping_filters github-ipa320-cob_environment_perception
cob_3d_mapping_geometry_map github-ipa320-cob_environment_perception
cob_3d_mapping_semantics github-ipa320-cob_environment_perception
cob_3d_mapping_slam github-ipa320-cob_environment_perception
cob_3d_mapping_tools github-ipa320-cob_environment_perception
cob_3d_registration github-ipa320-cob_environment_perception
cob_3d_segmentation github-ipa320-cob_environment_perception
cob_3d_transform_nodes github-ipa320-cob_environment_perception
cob_table_object_cluster github-ipa320-cob_environment_perception
cob_openni2_tracker github-ipa-rmb-cob_people_perception
cob_people_detection github-ipa-rmb-cob_people_perception
head_pose_estimation github-OSUrobotics-ros-head-tracking
object_recognition_clusters github-pal-robotics-object_recognition_clusters
ndt_costmap github-tstoyanov-perception_oru-release
ndt_map github-tstoyanov-perception_oru-release
ndt_map_builder github-tstoyanov-perception_oru-release
ndt_registration github-tstoyanov-perception_oru-release
ndt_visualisation github-tstoyanov-perception_oru-release
stereo_wall_detection github-PR2-pr2_plugs
sentis_tof_m100 github-voxel-dot-at-sentis_tof_m100_pkg
softkinetic_camera github-ipa320-softkinetic
tedusar_box_detection github-RoboCupTeam-TUGraz-tedusar_manipulation
slam_exporter github-uos-uos_slam
velodyne_height_map github-jack-oquin-velodyne_height_map
viso2_ros github-srv-viso2

Launch files

No launch files found

Services

No service files found

Plugins

Recent questions tagged pcl_ros at Robotics Stack Exchange

pcl_ros package from perception_pcl repo

pcl_ros perception_pcl

Package Summary

Tags No category tags.
Version 1.4.4
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/perception_pcl.git
VCS Type git
VCS Version kinetic-devel
Last Updated 2018-05-17
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Bill Morris
  • Kentaro Wada

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. See repository README.
CHANGELOG

Changelog for package pcl_ros

1.4.4 (2018-05-17)

  • Use nested foreach for the filtered patterns
  • Filter include dirs that does not exist Close https://github.com/ros-perception/perception_pcl/issues/172 Close https://github.com/ros-perception/perception_pcl/issues/206
  • Remove dependencies on not existing target
  • Fix use of Eigen3
  • Revert \"Increase limits on CropBox filter parameters\" This reverts commit e007128e41b189092a3311775a28c8ebbd8f13ad.
  • Increase limits on CropBox filter parameters Min and max of CropBox filter was +/- 5m. For a pointcloud from a Velodyne, for example, this is not enough. Increased to +/- 1000m.
  • Contributors: James Ward, Kentaro Wada

1.4.3 (2018-04-08)

1.4.2 (2018-04-03)

  • update to use non deprecated pluginlib macro
  • Fix config path of sample_voxel_grid.launch
  • remove hack now that upstream pcl has been rebuilt
  • Looser hzerror in test for extract_clusters to make it pass on Travis
  • Add sample & test for surface/convex_hull
  • Add sample & test for segmentation/extract_clusters.cpp
  • Add sample & test for io/concatenate_data.cpp
  • Add sample & test for features/normal_3d.cpp
  • Organize samples of pcl_ros/features
  • Add test arg to avoid duplicated testing
  • LazyNodelet for features/*
  • LazyNodelet for filters/ProjectInliers
  • Refactor io/PCDReader and io/PCDWriter as child of PCLNodelet
  • LazyNodelet for io/PointCloudConcatenateFieldsSynchronizer
  • LazyNodelet for io/PointCloudConcatenateDataSynchronizer
  • LazyNodelet for segmentation/SegmentDifferences
  • LazyNodelet for segmentation/SACSegmentationFromNormals
  • LazyNodelet for segmentation/SACSegmentation
  • LazyNodelet for segmentation/ExtractPolygonalPrismData
  • LazyNodelet for segmentation/EuclideanClusterExtraction
  • LazyNodelet for surface/MovingLeastSquares
  • LazyNodelet for surface/ConvexHull2D
  • Add missing COMPONENTS of PCL
  • Inherit NodeletLazy for pipeline with less cpu load
  • Set leaf_size 0.02
  • Install samples
  • Add sample and test for pcl/StatisticalOutlierRemoval Conflicts: pcl_ros/CMakeLists.txt
  • Add sample and test for pcl/VoxelGrid Conflicts: pcl_ros/CMakeLists.txt
  • no need to remove duplicates
  • spourious line change
  • remove now unnecessary build_depend on qtbase5
  • exclude PCL IO libraries exporting Qt flag
  • find only PCL components used instead of all PCL
  • Remove dependency on vtk/libproj-dev (#145) * Remove dependency on vtk/libproj-dev These dependencies were introduced in #124 to temporarily fix missing / wrong dependencies in upstream vtk. This hack is no longer necessary, since fixed vtk packages have been uploaded to packages.ros.org (see #124 and ros-infrastructure/reprepro-updater#32).

    • Remove vtk hack from CMakeLists.txt
  • Add dependency on qtbase5-dev for find_package(Qt5Widgets) See https://github.com/ros-perception/perception_pcl/pull/117#issuecomment-298158272 for detail.

  • Find Qt5Widgets to fix -lQt5::Widgets error

  • Add myname as a maintainer

  • Fix lib name duplication error

  • Detect automatically the version of PCL

  • Merge pull request #134 from ros-perception/install_plugins_xml Install xml files declaring nodelets

  • Install xml files declaring nodelets https://github.com/ros-perception/perception_pcl/commit/f81cded18b4f6d398b460a36c953fe6620a02bd6#commitcomment-21871201 \@scottnothing Thanks!

  • Merge pull request #132 from wkentaro/fix_syntax_nodelet_manifest Fix syntax of nodelet manifest file

  • Fix syntax of nodelet manifest file By splitting files for each library. Close #131

  • Contributors: Kentaro Wada, Mikael Arguedas, Paul Bovbel

1.4.0 (2016-04-22)

  • Fixup libproj-dev rosdep
  • Add build depend on libproj, since it\'s not provided by vtk right now
  • manually remove dependency on vtkproj from PCL_LIBRARIES
  • Remove python-vtk for kinetic-devel, see issue #44
  • Contributors: Jackie Kay, Paul Bovbel

1.3.0 (2015-06-22)

  • cleanup broken library links All removed library names are included in \${PCL_LIBRARIES}. However, the plain library names broke catkin\'s overlay mechanism: Where \${PCL_LIBRARIES} could point to a local installation of the PCL, e.g. pcd_ros_segmentation might still link to the system-wide installed version of pcl_segmentation.
  • Fixed test for jade-devel. Progress on #92
  • commented out test_tf_message_filter_pcl Until ros/geometry#80 has been merged the test will fail.
  • fixed indentation and author
  • Adds a test for tf message filters with pcl pointclouds
  • specialized HasHeader, TimeStamp, FrameId

    • HasHeader now returns false

    - TimeStamp and FrameId specialed for pcl::PointCloud<T> for any point type T These changes allow to use pcl::PointCloud with tf::MessageFilter

  • Sync pcl_nodelets.xml from hydro to indigo Fixes to pass catkin lint -W1

  • Fixes #87 for Indigo

  • Fixes #85 for Indigo

  • Fixes #77 and #80 for indigo

  • Added option to save pointclouds in binary and binary compressed format

  • Contributors: Brice Rebsamen, Lucid One, Mitchell Wills, v4hn

1.2.6 (2015-02-04)

1.2.5 (2015-01-20)

1.2.4 (2015-01-15)

1.2.3 (2015-01-10)

  • Update common.py Extended filter limits up to

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
ainstein_radar_filters github-AinsteinAI-ainstein_radar
ainstein_radar_tools github-AinsteinAI-ainstein_radar
ar_track_alvar github-ros-perception-ar_track_alvar
asr_descriptor_surface_based_recognition github-asr-ros-asr_descriptor_surface_based_recognition
asr_navfn github-asr-ros-asr_navfn
basler_tof github-uos-basler_tof
bta_tof_driver github-voxel-dot-at-bta_tof_driver
cis_camera github-tork-a-cis_camera
cob_map_accessibility_analysis github-ipa320-cob_navigation
cob_image_flip github-ipa320-cob_perception_common
cob_object_detection_visualizer github-ipa320-cob_perception_common
depthcloud_encoder github-RobotWebTools-depthcloud_encoder
ensenso_camera github-ensenso-ros_driver
grid_map_pcl github-anybotics-grid_map
haf_grasping github-davidfischinger-haf_grasping
ibeo_lux github-astuff-ibeo_lux
ira_laser_tools github-iralabdisco-ira_laser_tools
image_view2 github-jsk-ros-pkg-jsk_common
jsk_footstep_planner github-jsk-ros-pkg-jsk_control
jsk_pcl_ros github-jsk-ros-pkg-jsk_recognition
jsk_pcl_ros_utils github-jsk-ros-pkg-jsk_recognition
jsk_perception github-jsk-ros-pkg-jsk_recognition
jsk_recognition_utils github-jsk-ros-pkg-jsk_recognition
mcl_3dl github-at-wat-mcl_3dl
moveit_tutorials github-ros-planning-moveit_tutorials
multi_object_tracking_lidar github-praveen-palanisamy-multiple-object-tracking-lidar
base_local_planner github-ros-planning-navigation
costmap_2d github-ros-planning-navigation
navfn github-ros-planning-navigation
nearfield_map github-TUC-ProAut-ros_nearfield_map
safety_limiter github-at-wat-neonavigation
nonpersistent_voxel_layer github-SteveMacenski-nonpersistent_voxel_layer
octomap_server github-OctoMap-octomap_mapping
octomap_pa github-TUC-ProAut-ros_octomap
ouster_driver github-CPFL-ouster
pcdfilter_pa github-tuc-proaut-ros_pcdfilter
perception_pcl github-ros-perception-perception_pcl
pr2_tilt_laser_interface github-pr2-pr2_common_actions
pr2_navigation_perception github-PR2-prime-pr2_navigation
pr2_navigation_self_filter github-PR2-prime-pr2_navigation
semantic_point_annotator github-PR2-prime-pr2_navigation
rail_segmentation github-GT-RAIL-rail_segmentation
rc_cloud_accumulator github-roboception-rc_cloud_accumulator
rslidar_driver github-CPFL-robosense
rslidar_pointcloud github-CPFL-robosense
robot_self_filter github-pr2-robot_self_filter
rtabmap_ros github-introlab-rtabmap_ros
laser_ortho_projector github-ccny-ros-pkg-scan_tools
laser_scan_matcher github-ccny-ros-pkg-scan_tools
scan_to_cloud_converter github-ccny-ros-pkg-scan_tools
sciurus17_examples github-rt-net-sciurus17_ros
sciurus17_vision github-rt-net-sciurus17_ros
sick_ldmrs_tools github-SICKAG-sick_ldmrs_laser
sick_scan github-SICKAG-sick_scan
simple_grasping github-mikeferguson-simple_grasping
spatio_temporal_voxel_layer github-SteveMacenski-spatio_temporal_voxel_layer
uwsim github-uji-ros-pkg-underwater_simulation
velo2cam_calibration github-beltransen-velo2cam_calibration
pcl_recorder github-carla-simulator-ros-bridge
depth_sensor_pose github-mdrwiega-depth_nav_tools
ensenso github-crigroup-ensenso
fanuc_grinding_publish_meshfile gitlab-InstitutMaupertuis-fanuc_grinding
hector_costmap github-tu-darmstadt-ros-pkg-hector_navigation
hector_elevation_mapping github-tu-darmstadt-ros-pkg-hector_navigation
hector_soft_obstacle_detection github-tu-darmstadt-ros-pkg-hector_vision
hector_thermal_self_filter github-tu-darmstadt-ros-pkg-hector_vision
hector_barrel_detection_nodelet github-tu-darmstadt-ros-pkg-hector_visualization
hector_barrel_geotiff_plugin github-tu-darmstadt-ros-pkg-hector_visualization
hls_lfom_tof_driver github-HLDS-GIT-hls_lfom_tof_driver
humanoid_localization github-ROBOTIS-GIT-humanoid_navigation
ifm_o3mxxx github-takiaine-ifm_o3mxxx
industrial_extrinsic_cal github-ros-industrial-industrial_calibration
rgbd_depth_correction github-ros-industrial-industrial_calibration
lidar_camera_calibration github-ankitdhall-lidar_camera_calibration
livox_ros_driver github-Livox-SDK-livox_ros_driver
lslidar_n301_decoder github-leishen-lidar-LSN301
mitre_fast_layered_map github-mitre-mitre_fast_layered_map
o3m151_driver github-labex-imobs3-ifm_o3m151
object_recognition_transparent_objects github-wg-perception-transparent_objects
oculusprime github-xaxxontech-oculusprime_ros
feature_tracker github-tu-rbo-omip
joint_tracker github-tu-rbo-omip
omip_common github-tu-rbo-omip
rb_tracker github-tu-rbo-omip
phoxi_camera github-photoneo-phoxi_camera
rtt_pcl_ros github-orocos-rtt_pcl_ros
pointcloud_tools github-srv-srv_tools
turtlebot_arm_block_manipulation github-turtlebot-turtlebot_arm
turtlebot_arm_kinect_calibration github-turtlebot-turtlebot_arm

Messages

No message files found.

Services

No service files found

Recent questions tagged pcl_ros at Robotics Stack Exchange

pcl_ros package from perception_pcl repo

pcl_conversions pcl_ros perception_pcl

Package Summary

Tags No category tags.
Version 1.7.5
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/perception_pcl.git
VCS Type git
VCS Version melodic-devel
Last Updated 2023-02-15
Dev Status MAINTAINED
CI status
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Kentaro Wada
  • Steve Macenski

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. See repository README.
CHANGELOG

Changelog for package pcl_ros

1.7.5 (2023-01-19)

1.7.0 (2019-07-03)

  • Added option for fixed filename (via local parameter) (#102) (cherry picked from commit bd38533523fa5c00f320e6505a2c533e90f9d97e)
  • rewrote pcd_to_pointcloud to publish using a latched topic (#213)
    • pointcloud is published as a latched topic now
    • added functionality: ability to set config via parameters
  • Fix #150: Allow bag_to_pcd to properly respond to topic argument (#215) * Properly respond to topic argument fixing #150 Previously providing a topic name in argv[2], as indicated in the usage string, modified the printouts indicating to the user that they were going to be exporting the correct topic, but the rosbag::View::Query used still grabbed the first sensor_msgs/PointCloud2 topic which was not necessarily what they had specified.

    • Added more useful printouts and type-checking on input topic
  • Catch tf::TransformException in transformPointCloud (#223) * Catch TransformException in transformPointCloud This allows to catch all exceptions, not only tf::LookupException and tf::ExtrapolationException. Note that most of the code using transformPointCloud already (implicitly) assumes this function doesn\'t throw any exception, and they check the return value, which is false when an exception happened (or something went wrong). * Check for transformPointCloud return value In pcl_ros/src/pcl_ros/io/concatenate_data.cpp, which seems to be the only place where that check was missed.

  • Split off pcl_ros_filter into separate library (#239)

  • [Windows][melodic-devel] Fix Boost linkage issue and binary install location. (#238)

    • fix Windows build break. (#6)
    • Fix install path. (#7)
  • Wait for transform in transformPointCloud(). (#214)

  • Added tf2 versions of functions in transforms.h/hpp. (#231)

  • Switch to industrial_ci (#233)

    • Use industrial_ci
    • Run for all melodic target platforms
    • Artful EOL; verbose build and tests
    • Use travis_wait
    • Remove travis_wait
    • Download to devel space
    • Mark SYSTEM includes to avoid spurious warnings
    • Don\'t double-build PRs
  • use <chrono> and <thread> on Windows (#221)

    • Changing from usleep to c++14 style sleep_for for Windows support
  • Contributors: Enrique Fernandez Perdomo, James Xu, Jarvis Schultz, Martin Pecka, Paul Bovbel, Sean Yen, Stefan Kohlbrecher, Wolfgang Merkt, moooeeeep

1.6.2 (2018-05-20)

  • Fix exported includes in Ubuntu Artful
  • Increase limits on CropBox filter parameters
  • Contributors: James Ward, Jiri Horner

1.6.1 (2018-05-08)

  • Add 1.6.0 section to CHANGELOG.rst
  • Fix the use of Eigen3 in cmake
  • Contributors: Kentaro Wada

1.6.0 (2018-04-30)

  • Fix build and update maintainers
  • Add message_filters to find_package
  • Remove unnecessary dependency on genmsg
  • Contributors: Paul Bovbel, Kentaro Wada

1.5.4 (2018-03-31)

  • update to use non deprecated pluginlib macro
  • Fix config path of sample_voxel_grid.launch
  • remove hack now that upstream pcl has been rebuilt
  • Looser hzerror in test for extract_clusters to make it pass on Travis
  • Add sample & test for surface/convex_hull
  • Add sample & test for segmentation/extract_clusters.cpp
  • Add sample & test for io/concatenate_data.cpp
  • Add sample & test for features/normal_3d.cpp
  • Organize samples of pcl_ros/features
  • Add test arg to avoid duplicated testing
  • LazyNodelet for features/*
  • LazyNodelet for filters/ProjectInliers
  • Refactor io/PCDReader and io/PCDWriter as child of PCLNodelet
  • LazyNodelet for io/PointCloudConcatenateFieldsSynchronizer
  • LazyNodelet for io/PointCloudConcatenateDataSynchronizer
  • LazyNodelet for segmentation/SegmentDifferences
  • LazyNodelet for segmentation/SACSegmentationFromNormals
  • LazyNodelet for segmentation/SACSegmentation
  • LazyNodelet for segmentation/ExtractPolygonalPrismData
  • LazyNodelet for segmentation/EuclideanClusterExtraction
  • LazyNodelet for surface/MovingLeastSquares
  • LazyNodelet for surface/ConvexHull2D
  • Add missing COMPONENTS of PCL
  • Inherit NodeletLazy for pipeline with less cpu load
  • Set leaf_size 0.02
  • Install samples
  • Add sample and test for pcl/StatisticalOutlierRemoval Conflicts: pcl_ros/CMakeLists.txt
  • Add sample and test for pcl/VoxelGrid Conflicts: pcl_ros/CMakeLists.txt
  • no need to remove duplicates
  • spourious line change
  • remove now unnecessary build_depend on qtbase5
  • exclude PCL IO libraries exporting Qt flag
  • find only PCL components used instead of all PCL
  • Remove dependency on vtk/libproj-dev (#145) * Remove dependency on vtk/libproj-dev These dependencies were introduced in #124 to temporarily fix missing / wrong dependencies in upstream vtk. This hack is no longer necessary, since fixed vtk packages have been uploaded to packages.ros.org (see #124 and ros-infrastructure/reprepro-updater#32).

    • Remove vtk hack from CMakeLists.txt
  • Contributors: Kentaro Wada, Mikael Arguedas

1.5.3 (2017-05-03)

1.5.2 (2017-04-29)

  • Find Qt5Widgets to fix -lQt5::Widgets error
  • Contributors: Kentaro Wada

1.5.1 (2017-04-26)

  • Add my name as a maintainer
  • Contributors: Kentaro Wada

1.5.0 (2017-04-25)

  • Fix lib name duplication error in ubunt:zesty
  • Detect automatically the version of PCL in cmake
  • Install xml files declaring nodelets
  • Fix syntax of nodelet manifest file by splitting files for each library.
  • Contributors: Kentaro Wada

1.4.0 (2016-04-22)

  • Fixup libproj-dev rosdep
  • Add build depend on libproj, since it\'s not provided by vtk right now
  • manually remove dependency on vtkproj from PCL_LIBRARIES
  • Remove python-vtk for kinetic-devel, see issue #44
  • Contributors: Jackie Kay, Paul Bovbel

1.3.0 (2015-06-22)

  • cleanup broken library links All removed library names are included in \${PCL_LIBRARIES}. However, the plain library names broke catkin\'s overlay mechanism: Where \${PCL_LIBRARIES} could point to a local installation of the PCL, e.g. pcd_ros_segmentation might still link to the system-wide installed version of pcl_segmentation.
  • Fixed test for jade-devel. Progress on #92
  • commented out test_tf_message_filter_pcl Until ros/geometry#80 has been merged the test will fail.
  • fixed indentation and author
  • Adds a test for tf message filters with pcl pointclouds
  • specialized HasHeader, TimeStamp, FrameId

    • HasHeader now returns false

    - TimeStamp and FrameId specialed for pcl::PointCloud<T> for any point type T These changes allow to use pcl::PointCloud with tf::MessageFilter

  • Sync pcl_nodelets.xml from hydro to indigo Fixes to pass catkin lint -W1

  • Fixes #87 for Indigo

  • Fixes #85 for Indigo

  • Fixes #77 and #80 for indigo

  • Added option to save pointclouds in binary and binary compressed format

  • Contributors: Brice Rebsamen, Lucid One, Mitchell Wills, v4hn

1.2.6 (2015-02-04)

1.2.5 (2015-01-20)

1.2.4 (2015-01-15)

1.2.3 (2015-01-10)

  • Update common.py Extended filter limits up to

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
ainstein_radar_filters github-AinsteinAI-ainstein_radar
ainstein_radar_tools github-AinsteinAI-ainstein_radar
ar_track_alvar github-ros-perception-ar_track_alvar
asr_descriptor_surface_based_recognition github-asr-ros-asr_descriptor_surface_based_recognition
asr_navfn github-asr-ros-asr_navfn
basler_tof github-uos-basler_tof
bta_tof_driver github-voxel-dot-at-bta_tof_driver
cis_camera github-tork-a-cis_camera
cob_map_accessibility_analysis github-ipa320-cob_navigation
cob_image_flip github-ipa320-cob_perception_common
cob_object_detection_visualizer github-ipa320-cob_perception_common
points_preprocessor github-nobleo-core_perception
depthcloud_encoder github-RobotWebTools-depthcloud_encoder
ensenso_camera github-ensenso-ros_driver
floam github-flynneva-floam
grid_map_pcl github-anybotics-grid_map
haf_grasping github-davidfischinger-haf_grasping
ibeo_lux github-astuff-ibeo_lux
ira_laser_tools github-iralabdisco-ira_laser_tools
image_view2 github-jsk-ros-pkg-jsk_common
jsk_footstep_planner github-jsk-ros-pkg-jsk_control
jsk_pcl_ros github-jsk-ros-pkg-jsk_recognition
jsk_pcl_ros_utils github-jsk-ros-pkg-jsk_recognition
jsk_perception github-jsk-ros-pkg-jsk_recognition
jsk_recognition_utils github-jsk-ros-pkg-jsk_recognition
map_merge_3d github-hrnr-map-merge
mcl_3dl github-at-wat-mcl_3dl
moveit_tutorials github-ros-planning-moveit_tutorials
multi_object_tracking_lidar github-praveen-palanisamy-multiple-object-tracking-lidar
nearfield_map github-TUC-ProAut-ros_nearfield_map
safety_limiter github-at-wat-neonavigation
octomap_server github-OctoMap-octomap_mapping
octomap_pa github-TUC-ProAut-ros_octomap
ouster_driver github-CPFL-ouster
pcdfilter_pa github-tuc-proaut-ros_pcdfilter
perception_pcl github-ros-perception-perception_pcl
pf_driver github-PepperlFuchs-pf_lidar_ros_driver
pr2_tilt_laser_interface github-pr2-pr2_common_actions
pr2_navigation_perception github-PR2-pr2_navigation
pr2_navigation_self_filter github-PR2-pr2_navigation
semantic_point_annotator github-PR2-pr2_navigation
quanergy_client_ros github-QuanergySystems-quanergy_client_ros
rail_mesh_icp github-GT-RAIL-rail_mesh_icp
rail_segmentation github-GT-RAIL-rail_segmentation
rc_cloud_accumulator github-roboception-rc_cloud_accumulator
rslidar_driver github-CPFL-robosense
rslidar_pointcloud github-CPFL-robosense
robot_self_filter github-PR2-robot_self_filter
rtabmap_ros github-introlab-rtabmap_ros
laser_ortho_projector github-ccny-ros-pkg-scan_tools
laser_scan_matcher github-ccny-ros-pkg-scan_tools
scan_to_cloud_converter github-ccny-ros-pkg-scan_tools
sciurus17_examples github-rt-net-sciurus17_ros
sciurus17_vision github-rt-net-sciurus17_ros
sick_ldmrs_tools github-SICKAG-sick_ldmrs_laser
sick_scan github-SICKAG-sick_scan
simple_grasping github-mikeferguson-simple_grasping
backward_local_planner github-robosoft-ai-smacc
pure_spinning_local_planner github-robosoft-ai-smacc
undo_path_global_planner github-robosoft-ai-smacc
spatio_temporal_voxel_layer github-SteveMacenski-spatio_temporal_voxel_layer
uwsim github-uji-ros-pkg-underwater_simulation
velo2cam_calibration github-beltransen-velo2cam_calibration

Messages

No message files found.

Services

No service files found

Recent questions tagged pcl_ros at Robotics Stack Exchange