laser_geometry package from laser_geometry repo

laser_geometry

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/laser_geometry.git
VCS Type git
VCS Version humble
Last Updated 2022-03-01
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

This package contains a class for converting from a 2D laser scan as defined by sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud or sensor_msgs/PointCloud2. In particular, it contains functionality to account for the skew resulting from moving robots or tilting laser scanners.

Additional Links

Maintainers

  • Mabel Zhang

Authors

  • Dave Hershberger
  • Tully Foote
  • Radu Bogdan Rusu
  • William Woodall
README
No README found. No README in repository either.
CHANGELOG

Changelog for package laser_geometry

2.4.0 (2022-03-01)

  • Install headers to include/\${PROJECT_NAME} (#86)
  • Explicit cast to double to prevent loss of precision
  • Fix Duration casting issue leading to no undistortion
  • Contributors: Jonathan Binney, Marco Lampacrescia, Shane Loretz

2.3.0 (2022-01-14)

  • Fix building on running on Windows Debug (#82)
  • Update python code and tests for ros2 (#80)
  • Contributors: Chris Lalancette, Jonathan Binney

2.2.2 (2021-05-11)

  • Export sensor_msgs, tf2, and rclcpp as dependencies
  • Contributors: Mabel Zhang, Michel Hidalgo

2.2.1 (2020-12-08)

  • Use rclcpp::Duration::from_seconds (#72)
  • update maintainers
  • increase test timeout
  • Contributors: Dirk Thomas, Ivan Santiago Paunovic, Jonathan Binney, Mabel Zhang

2.2.0 (2020-04-30)

  • use ament_export_targets()
  • code style only: wrap after open parenthesis if not in one line (#52)
  • use target_include_directories
  • Drop CMake extras redundant with eigen3_cmake_module. (#50)
  • Contributors: Dirk Thomas, Jonathan Binney, Karsten Knese, Michel Hidalgo

2.1.0 (2019-09-27)

  • Merge pull request #46 from sloretz/eigen3_cmake_module
  • Contributors: Jonathan Binney, Shane Loretz

2.0.0 (2018-06-27)

  • Removed the angle dependency as no longer necessary.
  • Updated to build statically but use position independent code.
  • Updated to compile, and to remove PointCloud support, and remove boost.
  • Added visibility headers modified from rclcpp.
  • Updated laser_geometry to build for ros2 (and on Windows 10).
  • Improved use of numpy. (#14)
  • Contributors: Alessandro Bottero, Andreas Greimel, Brian Fjeldstad, Eric Wieser, Jon Binney, Jonathan Binney, Martin Idel, Mikael Arguedas, Vincent Rabaud, William Woodall

1.6.4 (2015-05-18)

  • Fix segfault when laserscan ranges[] is empty
  • Contributors: Timm Linder, Vincent Rabaud

1.6.3 (2015-03-07)

  • provide support for tf2
  • Contributors: Vincent Rabaud

1.6.2 (2014-06-08)

  • adds python port (only simple projection)
  • allows to have range_cutoff > range_max NOTE this is required if we need to keep the range_max readings in the point cloud. An example application is an obstacle_layer in a costmap.
  • Contributors: Vincent Rabaud, enriquefernandez

1.6.1 (2014-02-23)

  • Added dependency on cmake_modules
  • Contributors: William Woodall

1.6.0 (2014-02-21)

  • Adding William Woodall as a co-maintainer
  • Contributors: Vincent Rabaud, William Woodall

1.5.15 (2013-12-02)

  • Fix mistake in end_time calculation for scan transformation in #6

1.5.14 (2013-11-04)

  • Treat max_range as invalid measurement
  • Properly propagate range_cutoff
  • check for CATKIN_ENABLE_TESTING

1.5.13 (2013-10-06)

  • fixes #3

1.5.12 (2013-09-14)

  • fix case of Eigen find_package name

1.5.11 (2013-07-01)

  • added missing run deps

1.5.10 (2013-06-28 15:09)

  • [bugfix] export boost and eigen via DEPENDS

1.5.9 (2013-06-28 11:38)

  • [bugfix] export boost and eigen include dirs

1.5.8 (2012-12-14 13:54)

  • Added buildtool_depend on catkin

1.5.7 (2012-12-14 13:48)

  • CMake clean up

1.5.6 (2012-12-10)

  • Removed vestigial manifest.xml

1.5.5 (2012-11-15)

  • Added .count field (of 1) to every PointCloud2 field description. This fixes the bug referred to here: http://dev.pointclouds.org/issues/821 which is useful because that fix in PCL seems not to be released yet. Also this way is more correct, as far as I can tell.
  • Tidied up CMakeLists.txt based on Dirk\'s recommendations.

1.5.4 (2012-10-10)

  • added install rules to CMakeLists.txt needed for catkinization.
  • catkinized

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged laser_geometry at Robotics Stack Exchange

laser_geometry package from laser_geometry repo

laser_geometry

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/laser_geometry.git
VCS Type git
VCS Version iron
Last Updated 2023-02-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

This package contains a class for converting from a 2D laser scan as defined by sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud or sensor_msgs/PointCloud2. In particular, it contains functionality to account for the skew resulting from moving robots or tilting laser scanners.

Additional Links

Maintainers

  • Dharini Dutia

Authors

  • Dave Hershberger
  • Mabel Zhang
  • Radu Bogdan Rusu
  • Tully Foote
  • William Woodall
README
No README found. No README in repository either.
CHANGELOG

Changelog for package laser_geometry

2.5.0 (2023-02-14)

  • Update laser_geometry to C++17. (#90)
  • Update Maintainers (#88)
  • Mirror rolling to ros2
  • Contributors: Audrow Nash, Chris Lalancette

2.4.0 (2022-03-01)

  • Install headers to include/\${PROJECT_NAME} (#86)
  • Explicit cast to double to prevent loss of precision
  • Fix Duration casting issue leading to no undistortion
  • Contributors: Jonathan Binney, Marco Lampacrescia, Shane Loretz

2.3.0 (2022-01-14)

  • Fix building on running on Windows Debug (#82)
  • Update python code and tests for ros2 (#80)
  • Contributors: Chris Lalancette, Jonathan Binney

2.2.2 (2021-05-11)

  • Export sensor_msgs, tf2, and rclcpp as dependencies
  • Contributors: Mabel Zhang, Michel Hidalgo

2.2.1 (2020-12-08)

  • Use rclcpp::Duration::from_seconds (#72)
  • update maintainers
  • increase test timeout
  • Contributors: Dirk Thomas, Ivan Santiago Paunovic, Jonathan Binney, Mabel Zhang

2.2.0 (2020-04-30)

  • use ament_export_targets()
  • code style only: wrap after open parenthesis if not in one line (#52)
  • use target_include_directories
  • Drop CMake extras redundant with eigen3_cmake_module. (#50)
  • Contributors: Dirk Thomas, Jonathan Binney, Karsten Knese, Michel Hidalgo

2.1.0 (2019-09-27)

  • Merge pull request #46 from sloretz/eigen3_cmake_module
  • Contributors: Jonathan Binney, Shane Loretz

2.0.0 (2018-06-27)

  • Removed the angle dependency as no longer necessary.
  • Updated to build statically but use position independent code.
  • Updated to compile, and to remove PointCloud support, and remove boost.
  • Added visibility headers modified from rclcpp.
  • Updated laser_geometry to build for ros2 (and on Windows 10).
  • Improved use of numpy. (#14)
  • Contributors: Alessandro Bottero, Andreas Greimel, Brian Fjeldstad, Eric Wieser, Jon Binney, Jonathan Binney, Martin Idel, Mikael Arguedas, Vincent Rabaud, William Woodall

1.6.4 (2015-05-18)

  • Fix segfault when laserscan ranges[] is empty
  • Contributors: Timm Linder, Vincent Rabaud

1.6.3 (2015-03-07)

  • provide support for tf2
  • Contributors: Vincent Rabaud

1.6.2 (2014-06-08)

  • adds python port (only simple projection)
  • allows to have range_cutoff > range_max NOTE this is required if we need to keep the range_max readings in the point cloud. An example application is an obstacle_layer in a costmap.
  • Contributors: Vincent Rabaud, enriquefernandez

1.6.1 (2014-02-23)

  • Added dependency on cmake_modules
  • Contributors: William Woodall

1.6.0 (2014-02-21)

  • Adding William Woodall as a co-maintainer
  • Contributors: Vincent Rabaud, William Woodall

1.5.15 (2013-12-02)

  • Fix mistake in end_time calculation for scan transformation in #6

1.5.14 (2013-11-04)

  • Treat max_range as invalid measurement
  • Properly propagate range_cutoff
  • check for CATKIN_ENABLE_TESTING

1.5.13 (2013-10-06)

  • fixes #3

1.5.12 (2013-09-14)

  • fix case of Eigen find_package name

1.5.11 (2013-07-01)

  • added missing run deps

1.5.10 (2013-06-28 15:09)

  • [bugfix] export boost and eigen via DEPENDS

1.5.9 (2013-06-28 11:38)

  • [bugfix] export boost and eigen include dirs

1.5.8 (2012-12-14 13:54)

  • Added buildtool_depend on catkin

1.5.7 (2012-12-14 13:48)

  • CMake clean up

1.5.6 (2012-12-10)

  • Removed vestigial manifest.xml

1.5.5 (2012-11-15)

  • Added .count field (of 1) to every PointCloud2 field description. This fixes the bug referred to here: http://dev.pointclouds.org/issues/821 which is useful because that fix in PCL seems not to be released yet. Also this way is more correct, as far as I can tell.
  • Tidied up CMakeLists.txt based on Dirk\'s recommendations.

1.5.4 (2012-10-10)

  • added install rules to CMakeLists.txt needed for catkinization.
  • catkinized

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged laser_geometry at Robotics Stack Exchange

laser_geometry package from laser_geometry repo

laser_geometry

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/laser_geometry.git
VCS Type git
VCS Version rolling
Last Updated 2023-12-26
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

This package contains a class for converting from a 2D laser scan as defined by sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud or sensor_msgs/PointCloud2. In particular, it contains functionality to account for the skew resulting from moving robots or tilting laser scanners.

Additional Links

Maintainers

  • Dharini Dutia

Authors

  • Dave Hershberger
  • Mabel Zhang
  • Radu Bogdan Rusu
  • Tully Foote
  • William Woodall
README
No README found. No README in repository either.
CHANGELOG

Changelog for package laser_geometry

2.7.0 (2023-12-26)

  • Switch to target_link_libraries. (#92)
  • Contributors: Chris Lalancette

2.6.0 (2023-04-28)

2.5.0 (2023-02-14)

  • Update laser_geometry to C++17. (#90)
  • Update Maintainers (#88)
  • Mirror rolling to ros2
  • Contributors: Audrow Nash, Chris Lalancette

2.4.0 (2022-03-01)

  • Install headers to include/\${PROJECT_NAME} (#86)
  • Explicit cast to double to prevent loss of precision
  • Fix Duration casting issue leading to no undistortion
  • Contributors: Jonathan Binney, Marco Lampacrescia, Shane Loretz

2.3.0 (2022-01-14)

  • Fix building on running on Windows Debug (#82)
  • Update python code and tests for ros2 (#80)
  • Contributors: Chris Lalancette, Jonathan Binney

2.2.2 (2021-05-11)

  • Export sensor_msgs, tf2, and rclcpp as dependencies
  • Contributors: Mabel Zhang, Michel Hidalgo

2.2.1 (2020-12-08)

  • Use rclcpp::Duration::from_seconds (#72)
  • update maintainers
  • increase test timeout
  • Contributors: Dirk Thomas, Ivan Santiago Paunovic, Jonathan Binney, Mabel Zhang

2.2.0 (2020-04-30)

  • use ament_export_targets()
  • code style only: wrap after open parenthesis if not in one line (#52)
  • use target_include_directories
  • Drop CMake extras redundant with eigen3_cmake_module. (#50)
  • Contributors: Dirk Thomas, Jonathan Binney, Karsten Knese, Michel Hidalgo

2.1.0 (2019-09-27)

  • Merge pull request #46 from sloretz/eigen3_cmake_module
  • Contributors: Jonathan Binney, Shane Loretz

2.0.0 (2018-06-27)

  • Removed the angle dependency as no longer necessary.
  • Updated to build statically but use position independent code.
  • Updated to compile, and to remove PointCloud support, and remove boost.
  • Added visibility headers modified from rclcpp.
  • Updated laser_geometry to build for ros2 (and on Windows 10).
  • Improved use of numpy. (#14)
  • Contributors: Alessandro Bottero, Andreas Greimel, Brian Fjeldstad, Eric Wieser, Jon Binney, Jonathan Binney, Martin Idel, Mikael Arguedas, Vincent Rabaud, William Woodall

1.6.4 (2015-05-18)

  • Fix segfault when laserscan ranges[] is empty
  • Contributors: Timm Linder, Vincent Rabaud

1.6.3 (2015-03-07)

  • provide support for tf2
  • Contributors: Vincent Rabaud

1.6.2 (2014-06-08)

  • adds python port (only simple projection)
  • allows to have range_cutoff > range_max NOTE this is required if we need to keep the range_max readings in the point cloud. An example application is an obstacle_layer in a costmap.
  • Contributors: Vincent Rabaud, enriquefernandez

1.6.1 (2014-02-23)

  • Added dependency on cmake_modules
  • Contributors: William Woodall

1.6.0 (2014-02-21)

  • Adding William Woodall as a co-maintainer
  • Contributors: Vincent Rabaud, William Woodall

1.5.15 (2013-12-02)

  • Fix mistake in end_time calculation for scan transformation in #6

1.5.14 (2013-11-04)

  • Treat max_range as invalid measurement
  • Properly propagate range_cutoff
  • check for CATKIN_ENABLE_TESTING

1.5.13 (2013-10-06)

  • fixes #3

1.5.12 (2013-09-14)

  • fix case of Eigen find_package name

1.5.11 (2013-07-01)

  • added missing run deps

1.5.10 (2013-06-28 15:09)

  • [bugfix] export boost and eigen via DEPENDS

1.5.9 (2013-06-28 11:38)

  • [bugfix] export boost and eigen include dirs

1.5.8 (2012-12-14 13:54)

  • Added buildtool_depend on catkin

1.5.7 (2012-12-14 13:48)

  • CMake clean up

1.5.6 (2012-12-10)

  • Removed vestigial manifest.xml

1.5.5 (2012-11-15)

  • Added .count field (of 1) to every PointCloud2 field description. This fixes the bug referred to here: http://dev.pointclouds.org/issues/821 which is useful because that fix in PCL seems not to be released yet. Also this way is more correct, as far as I can tell.
  • Tidied up CMakeLists.txt based on Dirk\'s recommendations.

1.5.4 (2012-10-10)

  • added install rules to CMakeLists.txt needed for catkinization.
  • catkinized

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged laser_geometry at Robotics Stack Exchange

laser_geometry package from laser_geometry repo

laser_geometry

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/laser_geometry.git
VCS Type git
VCS Version kinetic-devel
Last Updated 2022-08-19
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

This package contains a class for converting from a 2D laser scan as defined by sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud or sensor_msgs/PointCloud2. In particular, it contains functionality to account for the skew resulting from moving robots or tilting laser scanners.

Additional Links

Maintainers

  • Dave Hershberger
  • Mabel Zhang

Authors

  • Tully Foote
  • Radu Bogdan Rusu
  • William Woodall
README
No README found. No README in repository either.
CHANGELOG

Changelog for package laser_geometry

1.6.7 (2021-02-05)

  • Require C++11
  • Contributors: Mabel Zhang, Martin Pecka

1.6.6 (2021-01-14)

  • Handle FindEigen3 module\'s differing definitions, define [EIGEN3_INCLUDE_DIRS]{.title-ref} with [EIGEN3_INCLUDE_DIR]{.title-ref}.
  • update maintainers
  • Added transformLaserScanToPointCloud() version utilizing fixed frame.
  • Contributors: Jonathan Binney, Mabel Zhang, Martin Pecka, Scott K Logan

1.6.5 (2020-03-13)

  • Bump CMake version to avoid CMP0048
  • Update package.xml to schema version 3
  • Choose python version based on what ros is using
  • Make rostest headers available to projection_test
  • Remove unneeded time header - it was breaking windows builds.
  • add DLL import/export macro
  • export dll on Windows
  • rename visibility macro
  • windows bringup
  • extend CMake install targets
  • Add dependency on tf2 for downstream packages
  • Update and fix package.xml Eigen dependency
  • Export Eigen dependency
  • Create LICENSE
  • Better use of numpy
  • Contributors: Eric Wieser, James Xu, Jochen Sprickerhof, Jon Binney, Jonathan Binney, Scott K Logan, Shane Loretz, Tully Foote, Vincent Rabaud, William Woodall

1.6.4 (2015-05-18)

  • Fix segfault when laserscan ranges[] is empty
  • Contributors: Timm Linder, Vincent Rabaud

1.6.3 (2015-03-07)

  • provide support for tf2
  • Contributors: Vincent Rabaud

1.6.2 (2014-06-08)

  • adds python port (only simple projection)
  • allows to have range_cutoff > range_max NOTE this is required if we need to keep the range_max readings in the point cloud. An example application is an obstacle_layer in a costmap.
  • Contributors: Vincent Rabaud, enriquefernandez

1.6.1 (2014-02-23)

  • Added dependency on cmake_modules
  • Contributors: William Woodall

1.6.0 (2014-02-21)

  • Adding William Woodall as a co-maintainer
  • Contributors: Vincent Rabaud, William Woodall

1.5.15 (2013-12-02)

  • Fix mistake in end_time calculation for scan transformation in #6

1.5.14 (2013-11-04)

  • Treat max_range as invalid measurement
  • Properly propagate range_cutoff
  • check for CATKIN_ENABLE_TESTING

1.5.13 (2013-10-06)

  • fixes #3

1.5.12 (2013-09-14)

  • fix case of Eigen find_package name

1.5.11 (2013-07-01)

  • added missing run deps

1.5.10 (2013-06-28 15:09)

  • [bugfix] export boost and eigen via DEPENDS

1.5.9 (2013-06-28 11:38)

  • [bugfix] export boost and eigen include dirs

1.5.8 (2012-12-14 13:54)

  • Added buildtool_depend on catkin

1.5.7 (2012-12-14 13:48)

  • CMake clean up

1.5.6 (2012-12-10)

  • Removed vestigial manifest.xml

1.5.5 (2012-11-15)

  • Added .count field (of 1) to every PointCloud2 field description. This fixes the bug referred to here: http://dev.pointclouds.org/issues/821 which is useful because that fix in PCL seems not to be released yet. Also this way is more correct, as far as I can tell.
  • Tidied up CMakeLists.txt based on Dirk\'s recommendations.

1.5.4 (2012-10-10)

  • added install rules to CMakeLists.txt needed for catkinization.
  • catkinized

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged laser_geometry at Robotics Stack Exchange

laser_geometry package from laser_geometry repo

laser_geometry

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/laser_geometry.git
VCS Type git
VCS Version ros2
Last Updated 2023-12-26
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

This package contains a class for converting from a 2D laser scan as defined by sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud or sensor_msgs/PointCloud2. In particular, it contains functionality to account for the skew resulting from moving robots or tilting laser scanners.

Additional Links

Maintainers

  • Dharini Dutia

Authors

  • Dave Hershberger
  • Mabel Zhang
  • Radu Bogdan Rusu
  • Tully Foote
  • William Woodall
README
No README found. No README in repository either.
CHANGELOG

Changelog for package laser_geometry

2.7.0 (2023-12-26)

  • Switch to target_link_libraries. (#92)
  • Contributors: Chris Lalancette

2.6.0 (2023-04-28)

2.5.0 (2023-02-14)

  • Update laser_geometry to C++17. (#90)
  • Update Maintainers (#88)
  • Mirror rolling to ros2
  • Contributors: Audrow Nash, Chris Lalancette

2.4.0 (2022-03-01)

  • Install headers to include/\${PROJECT_NAME} (#86)
  • Explicit cast to double to prevent loss of precision
  • Fix Duration casting issue leading to no undistortion
  • Contributors: Jonathan Binney, Marco Lampacrescia, Shane Loretz

2.3.0 (2022-01-14)

  • Fix building on running on Windows Debug (#82)
  • Update python code and tests for ros2 (#80)
  • Contributors: Chris Lalancette, Jonathan Binney

2.2.2 (2021-05-11)

  • Export sensor_msgs, tf2, and rclcpp as dependencies
  • Contributors: Mabel Zhang, Michel Hidalgo

2.2.1 (2020-12-08)

  • Use rclcpp::Duration::from_seconds (#72)
  • update maintainers
  • increase test timeout
  • Contributors: Dirk Thomas, Ivan Santiago Paunovic, Jonathan Binney, Mabel Zhang

2.2.0 (2020-04-30)

  • use ament_export_targets()
  • code style only: wrap after open parenthesis if not in one line (#52)
  • use target_include_directories
  • Drop CMake extras redundant with eigen3_cmake_module. (#50)
  • Contributors: Dirk Thomas, Jonathan Binney, Karsten Knese, Michel Hidalgo

2.1.0 (2019-09-27)

  • Merge pull request #46 from sloretz/eigen3_cmake_module
  • Contributors: Jonathan Binney, Shane Loretz

2.0.0 (2018-06-27)

  • Removed the angle dependency as no longer necessary.
  • Updated to build statically but use position independent code.
  • Updated to compile, and to remove PointCloud support, and remove boost.
  • Added visibility headers modified from rclcpp.
  • Updated laser_geometry to build for ros2 (and on Windows 10).
  • Improved use of numpy. (#14)
  • Contributors: Alessandro Bottero, Andreas Greimel, Brian Fjeldstad, Eric Wieser, Jon Binney, Jonathan Binney, Martin Idel, Mikael Arguedas, Vincent Rabaud, William Woodall

1.6.4 (2015-05-18)

  • Fix segfault when laserscan ranges[] is empty
  • Contributors: Timm Linder, Vincent Rabaud

1.6.3 (2015-03-07)

  • provide support for tf2
  • Contributors: Vincent Rabaud

1.6.2 (2014-06-08)

  • adds python port (only simple projection)
  • allows to have range_cutoff > range_max NOTE this is required if we need to keep the range_max readings in the point cloud. An example application is an obstacle_layer in a costmap.
  • Contributors: Vincent Rabaud, enriquefernandez

1.6.1 (2014-02-23)

  • Added dependency on cmake_modules
  • Contributors: William Woodall

1.6.0 (2014-02-21)

  • Adding William Woodall as a co-maintainer
  • Contributors: Vincent Rabaud, William Woodall

1.5.15 (2013-12-02)

  • Fix mistake in end_time calculation for scan transformation in #6

1.5.14 (2013-11-04)

  • Treat max_range as invalid measurement
  • Properly propagate range_cutoff
  • check for CATKIN_ENABLE_TESTING

1.5.13 (2013-10-06)

  • fixes #3

1.5.12 (2013-09-14)

  • fix case of Eigen find_package name

1.5.11 (2013-07-01)

  • added missing run deps

1.5.10 (2013-06-28 15:09)

  • [bugfix] export boost and eigen via DEPENDS

1.5.9 (2013-06-28 11:38)

  • [bugfix] export boost and eigen include dirs

1.5.8 (2012-12-14 13:54)

  • Added buildtool_depend on catkin

1.5.7 (2012-12-14 13:48)

  • CMake clean up

1.5.6 (2012-12-10)

  • Removed vestigial manifest.xml

1.5.5 (2012-11-15)

  • Added .count field (of 1) to every PointCloud2 field description. This fixes the bug referred to here: http://dev.pointclouds.org/issues/821 which is useful because that fix in PCL seems not to be released yet. Also this way is more correct, as far as I can tell.
  • Tidied up CMakeLists.txt based on Dirk\'s recommendations.

1.5.4 (2012-10-10)

  • added install rules to CMakeLists.txt needed for catkinization.
  • catkinized

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged laser_geometry at Robotics Stack Exchange

laser_geometry package from laser_geometry repo

laser_geometry

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/laser_geometry.git
VCS Type git
VCS Version crystal
Last Updated 2018-06-28
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

This package contains a class for converting from a 2D laser scan as defined by sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud or sensor_msgs/PointCloud2. In particular, it contains functionality to account for the skew resulting from moving robots or tilting laser scanners.

Additional Links

Maintainers

  • William Woodall

Authors

  • Dave Hershberger
  • Tully Foote
  • Radu Bogdan Rusu
README
No README found. No README in repository either.
CHANGELOG

Changelog for package laser_geometry

2.0.0 (2018-06-27)

  • Removed the angle dependency as no longer necessary.
  • Updated to build statically but use position independent code.
  • Updated to compile, and to remove PointCloud support, and remove boost.
  • Added visibility headers modified from rclcpp.
  • Updated laser_geometry to build for ros2 (and on Windows 10).
  • Improved use of numpy. (#14)
  • Contributors: Alessandro Bottero, Andreas Greimel, Brian Fjeldstad, Eric Wieser, Jon Binney, Jonathan Binney, Martin Idel, Mikael Arguedas, Vincent Rabaud, William Woodall

1.6.4 (2015-05-18)

  • Fix segfault when laserscan ranges[] is empty
  • Contributors: Timm Linder, Vincent Rabaud

1.6.3 (2015-03-07)

  • provide support for tf2
  • Contributors: Vincent Rabaud

1.6.2 (2014-06-08)

  • adds python port (only simple projection)
  • allows to have range_cutoff > range_max NOTE this is required if we need to keep the range_max readings in the point cloud. An example application is an obstacle_layer in a costmap.
  • Contributors: Vincent Rabaud, enriquefernandez

1.6.1 (2014-02-23)

  • Added dependency on cmake_modules
  • Contributors: William Woodall

1.6.0 (2014-02-21)

  • Adding William Woodall as a co-maintainer
  • Contributors: Vincent Rabaud, William Woodall

1.5.15 (2013-12-02)

  • Fix mistake in end_time calculation for scan transformation in #6

1.5.14 (2013-11-04)

  • Treat max_range as invalid measurement
  • Properly propagate range_cutoff
  • check for CATKIN_ENABLE_TESTING

1.5.13 (2013-10-06)

  • fixes #3

1.5.12 (2013-09-14)

  • fix case of Eigen find_package name

1.5.11 (2013-07-01)

  • added missing run deps

1.5.10 (2013-06-28 15:09)

  • [bugfix] export boost and eigen via DEPENDS

1.5.9 (2013-06-28 11:38)

  • [bugfix] export boost and eigen include dirs

1.5.8 (2012-12-14 13:54)

  • Added buildtool_depend on catkin

1.5.7 (2012-12-14 13:48)

  • CMake clean up

1.5.6 (2012-12-10)

  • Removed vestigial manifest.xml

1.5.5 (2012-11-15)

  • Added .count field (of 1) to every PointCloud2 field description. This fixes the bug referred to here: http://dev.pointclouds.org/issues/821 which is useful because that fix in PCL seems not to be released yet. Also this way is more correct, as far as I can tell.
  • Tidied up CMakeLists.txt based on Dirk\'s recommendations.

1.5.4 (2012-10-10)

  • added install rules to CMakeLists.txt needed for catkinization.
  • catkinized

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged laser_geometry at Robotics Stack Exchange

laser_geometry package from laser_geometry repo

laser_geometry

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/laser_geometry.git
VCS Type git
VCS Version eloquent
Last Updated 2020-02-06
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

This package contains a class for converting from a 2D laser scan as defined by sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud or sensor_msgs/PointCloud2. In particular, it contains functionality to account for the skew resulting from moving robots or tilting laser scanners.

Additional Links

Maintainers

  • William Woodall

Authors

  • Dave Hershberger
  • Tully Foote
  • Radu Bogdan Rusu
README
No README found. No README in repository either.
CHANGELOG

Changelog for package laser_geometry

2.1.1 (2020-02-05)

  • use target_include_directories Signed-off-by: Karsten Knese <karsten@openrobotics.org>
  • Contributors: Jonathan Binney, Karsten Knese

2.1.0 (2019-09-27)

  • Merge pull request #46 from sloretz/eigen3_cmake_module
  • Contributors: Jonathan Binney, Shane Loretz

2.0.0 (2018-06-27)

  • Removed the angle dependency as no longer necessary.
  • Updated to build statically but use position independent code.
  • Updated to compile, and to remove PointCloud support, and remove boost.
  • Added visibility headers modified from rclcpp.
  • Updated laser_geometry to build for ros2 (and on Windows 10).
  • Improved use of numpy. (#14)
  • Contributors: Alessandro Bottero, Andreas Greimel, Brian Fjeldstad, Eric Wieser, Jon Binney, Jonathan Binney, Martin Idel, Mikael Arguedas, Vincent Rabaud, William Woodall

1.6.4 (2015-05-18)

  • Fix segfault when laserscan ranges[] is empty
  • Contributors: Timm Linder, Vincent Rabaud

1.6.3 (2015-03-07)

  • provide support for tf2
  • Contributors: Vincent Rabaud

1.6.2 (2014-06-08)

  • adds python port (only simple projection)
  • allows to have range_cutoff > range_max NOTE this is required if we need to keep the range_max readings in the point cloud. An example application is an obstacle_layer in a costmap.
  • Contributors: Vincent Rabaud, enriquefernandez

1.6.1 (2014-02-23)

  • Added dependency on cmake_modules
  • Contributors: William Woodall

1.6.0 (2014-02-21)

  • Adding William Woodall as a co-maintainer
  • Contributors: Vincent Rabaud, William Woodall

1.5.15 (2013-12-02)

  • Fix mistake in end_time calculation for scan transformation in #6

1.5.14 (2013-11-04)

  • Treat max_range as invalid measurement
  • Properly propagate range_cutoff
  • check for CATKIN_ENABLE_TESTING

1.5.13 (2013-10-06)

  • fixes #3

1.5.12 (2013-09-14)

  • fix case of Eigen find_package name

1.5.11 (2013-07-01)

  • added missing run deps

1.5.10 (2013-06-28 15:09)

  • [bugfix] export boost and eigen via DEPENDS

1.5.9 (2013-06-28 11:38)

  • [bugfix] export boost and eigen include dirs

1.5.8 (2012-12-14 13:54)

  • Added buildtool_depend on catkin

1.5.7 (2012-12-14 13:48)

  • CMake clean up

1.5.6 (2012-12-10)

  • Removed vestigial manifest.xml

1.5.5 (2012-11-15)

  • Added .count field (of 1) to every PointCloud2 field description. This fixes the bug referred to here: http://dev.pointclouds.org/issues/821 which is useful because that fix in PCL seems not to be released yet. Also this way is more correct, as far as I can tell.
  • Tidied up CMakeLists.txt based on Dirk\'s recommendations.

1.5.4 (2012-10-10)

  • added install rules to CMakeLists.txt needed for catkinization.
  • catkinized

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged laser_geometry at Robotics Stack Exchange

laser_geometry package from laser_geometry repo

laser_geometry

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/laser_geometry.git
VCS Type git
VCS Version dashing
Last Updated 2020-09-09
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

This package contains a class for converting from a 2D laser scan as defined by sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud or sensor_msgs/PointCloud2. In particular, it contains functionality to account for the skew resulting from moving robots or tilting laser scanners.

Additional Links

Maintainers

  • William Woodall

Authors

  • Dave Hershberger
  • Tully Foote
  • Radu Bogdan Rusu
README
No README found. No README in repository either.
CHANGELOG

Changelog for package laser_geometry

2.0.0 (2018-06-27)

  • Removed the angle dependency as no longer necessary.
  • Updated to build statically but use position independent code.
  • Updated to compile, and to remove PointCloud support, and remove boost.
  • Added visibility headers modified from rclcpp.
  • Updated laser_geometry to build for ros2 (and on Windows 10).
  • Improved use of numpy. (#14)
  • Contributors: Alessandro Bottero, Andreas Greimel, Brian Fjeldstad, Eric Wieser, Jon Binney, Jonathan Binney, Martin Idel, Mikael Arguedas, Vincent Rabaud, William Woodall

1.6.4 (2015-05-18)

  • Fix segfault when laserscan ranges[] is empty
  • Contributors: Timm Linder, Vincent Rabaud

1.6.3 (2015-03-07)

  • provide support for tf2
  • Contributors: Vincent Rabaud

1.6.2 (2014-06-08)

  • adds python port (only simple projection)
  • allows to have range_cutoff > range_max NOTE this is required if we need to keep the range_max readings in the point cloud. An example application is an obstacle_layer in a costmap.
  • Contributors: Vincent Rabaud, enriquefernandez

1.6.1 (2014-02-23)

  • Added dependency on cmake_modules
  • Contributors: William Woodall

1.6.0 (2014-02-21)

  • Adding William Woodall as a co-maintainer
  • Contributors: Vincent Rabaud, William Woodall

1.5.15 (2013-12-02)

  • Fix mistake in end_time calculation for scan transformation in #6

1.5.14 (2013-11-04)

  • Treat max_range as invalid measurement
  • Properly propagate range_cutoff
  • check for CATKIN_ENABLE_TESTING

1.5.13 (2013-10-06)

  • fixes #3

1.5.12 (2013-09-14)

  • fix case of Eigen find_package name

1.5.11 (2013-07-01)

  • added missing run deps

1.5.10 (2013-06-28 15:09)

  • [bugfix] export boost and eigen via DEPENDS

1.5.9 (2013-06-28 11:38)

  • [bugfix] export boost and eigen include dirs

1.5.8 (2012-12-14 13:54)

  • Added buildtool_depend on catkin

1.5.7 (2012-12-14 13:48)

  • CMake clean up

1.5.6 (2012-12-10)

  • Removed vestigial manifest.xml

1.5.5 (2012-11-15)

  • Added .count field (of 1) to every PointCloud2 field description. This fixes the bug referred to here: http://dev.pointclouds.org/issues/821 which is useful because that fix in PCL seems not to be released yet. Also this way is more correct, as far as I can tell.
  • Tidied up CMakeLists.txt based on Dirk\'s recommendations.

1.5.4 (2012-10-10)

  • added install rules to CMakeLists.txt needed for catkinization.
  • catkinized

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged laser_geometry at Robotics Stack Exchange

laser_geometry package from laser_geometry repo

laser_geometry

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/laser_geometry.git
VCS Type git
VCS Version galactic
Last Updated 2021-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

This package contains a class for converting from a 2D laser scan as defined by sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud or sensor_msgs/PointCloud2. In particular, it contains functionality to account for the skew resulting from moving robots or tilting laser scanners.

Additional Links

Maintainers

  • Mabel Zhang

Authors

  • Dave Hershberger
  • Tully Foote
  • Radu Bogdan Rusu
  • William Woodall
README
No README found. No README in repository either.
CHANGELOG

Changelog for package laser_geometry

2.2.2 (2021-05-11)

  • Export sensor_msgs, tf2, and rclcpp as dependencies
  • Contributors: Mabel Zhang, Michel Hidalgo

2.2.1 (2020-12-08)

  • Use rclcpp::Duration::from_seconds (#72)
  • update maintainers
  • increase test timeout
  • Contributors: Dirk Thomas, Ivan Santiago Paunovic, Jonathan Binney, Mabel Zhang

2.2.0 (2020-04-30)

  • use ament_export_targets()
  • code style only: wrap after open parenthesis if not in one line (#52)
  • use target_include_directories
  • Drop CMake extras redundant with eigen3_cmake_module. (#50)
  • Contributors: Dirk Thomas, Jonathan Binney, Karsten Knese, Michel Hidalgo

2.1.0 (2019-09-27)

  • Merge pull request #46 from sloretz/eigen3_cmake_module
  • Contributors: Jonathan Binney, Shane Loretz

2.0.0 (2018-06-27)

  • Removed the angle dependency as no longer necessary.
  • Updated to build statically but use position independent code.
  • Updated to compile, and to remove PointCloud support, and remove boost.
  • Added visibility headers modified from rclcpp.
  • Updated laser_geometry to build for ros2 (and on Windows 10).
  • Improved use of numpy. (#14)
  • Contributors: Alessandro Bottero, Andreas Greimel, Brian Fjeldstad, Eric Wieser, Jon Binney, Jonathan Binney, Martin Idel, Mikael Arguedas, Vincent Rabaud, William Woodall

1.6.4 (2015-05-18)

  • Fix segfault when laserscan ranges[] is empty
  • Contributors: Timm Linder, Vincent Rabaud

1.6.3 (2015-03-07)

  • provide support for tf2
  • Contributors: Vincent Rabaud

1.6.2 (2014-06-08)

  • adds python port (only simple projection)
  • allows to have range_cutoff > range_max NOTE this is required if we need to keep the range_max readings in the point cloud. An example application is an obstacle_layer in a costmap.
  • Contributors: Vincent Rabaud, enriquefernandez

1.6.1 (2014-02-23)

  • Added dependency on cmake_modules
  • Contributors: William Woodall

1.6.0 (2014-02-21)

  • Adding William Woodall as a co-maintainer
  • Contributors: Vincent Rabaud, William Woodall

1.5.15 (2013-12-02)

  • Fix mistake in end_time calculation for scan transformation in #6

1.5.14 (2013-11-04)

  • Treat max_range as invalid measurement
  • Properly propagate range_cutoff
  • check for CATKIN_ENABLE_TESTING

1.5.13 (2013-10-06)

  • fixes #3

1.5.12 (2013-09-14)

  • fix case of Eigen find_package name

1.5.11 (2013-07-01)

  • added missing run deps

1.5.10 (2013-06-28 15:09)

  • [bugfix] export boost and eigen via DEPENDS

1.5.9 (2013-06-28 11:38)

  • [bugfix] export boost and eigen include dirs

1.5.8 (2012-12-14 13:54)

  • Added buildtool_depend on catkin

1.5.7 (2012-12-14 13:48)

  • CMake clean up

1.5.6 (2012-12-10)

  • Removed vestigial manifest.xml

1.5.5 (2012-11-15)

  • Added .count field (of 1) to every PointCloud2 field description. This fixes the bug referred to here: http://dev.pointclouds.org/issues/821 which is useful because that fix in PCL seems not to be released yet. Also this way is more correct, as far as I can tell.
  • Tidied up CMakeLists.txt based on Dirk\'s recommendations.

1.5.4 (2012-10-10)

  • added install rules to CMakeLists.txt needed for catkinization.
  • catkinized

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged laser_geometry at Robotics Stack Exchange

laser_geometry package from laser_geometry repo

laser_geometry

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/laser_geometry.git
VCS Type git
VCS Version foxy
Last Updated 2020-04-30
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

This package contains a class for converting from a 2D laser scan as defined by sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud or sensor_msgs/PointCloud2. In particular, it contains functionality to account for the skew resulting from moving robots or tilting laser scanners.

Additional Links

Maintainers

  • William Woodall

Authors

  • Dave Hershberger
  • Tully Foote
  • Radu Bogdan Rusu
README
No README found. No README in repository either.
CHANGELOG

Changelog for package laser_geometry

2.2.0 (2020-04-30)

  • use ament_export_targets()
  • code style only: wrap after open parenthesis if not in one line (#52)
  • use target_include_directories
  • Drop CMake extras redundant with eigen3_cmake_module. (#50)
  • Contributors: Dirk Thomas, Jonathan Binney, Karsten Knese, Michel Hidalgo

2.1.0 (2019-09-27)

  • Merge pull request #46 from sloretz/eigen3_cmake_module
  • Contributors: Jonathan Binney, Shane Loretz

2.0.0 (2018-06-27)

  • Removed the angle dependency as no longer necessary.
  • Updated to build statically but use position independent code.
  • Updated to compile, and to remove PointCloud support, and remove boost.
  • Added visibility headers modified from rclcpp.
  • Updated laser_geometry to build for ros2 (and on Windows 10).
  • Improved use of numpy. (#14)
  • Contributors: Alessandro Bottero, Andreas Greimel, Brian Fjeldstad, Eric Wieser, Jon Binney, Jonathan Binney, Martin Idel, Mikael Arguedas, Vincent Rabaud, William Woodall

1.6.4 (2015-05-18)

  • Fix segfault when laserscan ranges[] is empty
  • Contributors: Timm Linder, Vincent Rabaud

1.6.3 (2015-03-07)

  • provide support for tf2
  • Contributors: Vincent Rabaud

1.6.2 (2014-06-08)

  • adds python port (only simple projection)
  • allows to have range_cutoff > range_max NOTE this is required if we need to keep the range_max readings in the point cloud. An example application is an obstacle_layer in a costmap.
  • Contributors: Vincent Rabaud, enriquefernandez

1.6.1 (2014-02-23)

  • Added dependency on cmake_modules
  • Contributors: William Woodall

1.6.0 (2014-02-21)

  • Adding William Woodall as a co-maintainer
  • Contributors: Vincent Rabaud, William Woodall

1.5.15 (2013-12-02)

  • Fix mistake in end_time calculation for scan transformation in #6

1.5.14 (2013-11-04)

  • Treat max_range as invalid measurement
  • Properly propagate range_cutoff
  • check for CATKIN_ENABLE_TESTING

1.5.13 (2013-10-06)

  • fixes #3

1.5.12 (2013-09-14)

  • fix case of Eigen find_package name

1.5.11 (2013-07-01)

  • added missing run deps

1.5.10 (2013-06-28 15:09)

  • [bugfix] export boost and eigen via DEPENDS

1.5.9 (2013-06-28 11:38)

  • [bugfix] export boost and eigen include dirs

1.5.8 (2012-12-14 13:54)

  • Added buildtool_depend on catkin

1.5.7 (2012-12-14 13:48)

  • CMake clean up

1.5.6 (2012-12-10)

  • Removed vestigial manifest.xml

1.5.5 (2012-11-15)

  • Added .count field (of 1) to every PointCloud2 field description. This fixes the bug referred to here: http://dev.pointclouds.org/issues/821 which is useful because that fix in PCL seems not to be released yet. Also this way is more correct, as far as I can tell.
  • Tidied up CMakeLists.txt based on Dirk\'s recommendations.

1.5.4 (2012-10-10)

  • added install rules to CMakeLists.txt needed for catkinization.
  • catkinized

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged laser_geometry at Robotics Stack Exchange

laser_geometry package from laser_geometry repo

laser_geometry

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/laser_geometry.git
VCS Type git
VCS Version indigo-devel
Last Updated 2019-10-23
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

This package contains a class for converting from a 2D laser scan as defined by sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud or sensor_msgs/PointCloud2. In particular, it contains functionality to account for the skew resulting from moving robots or tilting laser scanners.

Additional Links

Maintainers

  • Dave Hershberger
  • William Woodall

Authors

  • Tully Foote
  • Radu Bogdan Rusu
README
No README found. No README in repository either.
CHANGELOG

Changelog for package laser_geometry

1.6.4 (2015-05-18)

  • Fix segfault when laserscan ranges[] is empty
  • Contributors: Timm Linder, Vincent Rabaud

1.6.3 (2015-03-07)

  • provide support for tf2
  • Contributors: Vincent Rabaud

1.6.2 (2014-06-08)

  • adds python port (only simple projection)
  • allows to have range_cutoff > range_max NOTE this is required if we need to keep the range_max readings in the point cloud. An example application is an obstacle_layer in a costmap.
  • Contributors: Vincent Rabaud, enriquefernandez

1.6.1 (2014-02-23)

  • Added dependency on cmake_modules
  • Contributors: William Woodall

1.6.0 (2014-02-21)

  • Adding William Woodall as a co-maintainer
  • Contributors: Vincent Rabaud, William Woodall

1.5.15 (2013-12-02)

  • Fix mistake in end_time calculation for scan transformation in #6

1.5.14 (2013-11-04)

  • Treat max_range as invalid measurement
  • Properly propagate range_cutoff
  • check for CATKIN_ENABLE_TESTING

1.5.13 (2013-10-06)

  • fixes #3

1.5.12 (2013-09-14)

  • fix case of Eigen find_package name

1.5.11 (2013-07-01)

  • added missing run deps

1.5.10 (2013-06-28 15:09)

  • [bugfix] export boost and eigen via DEPENDS

1.5.9 (2013-06-28 11:38)

  • [bugfix] export boost and eigen include dirs

1.5.8 (2012-12-14 13:54)

  • Added buildtool_depend on catkin

1.5.7 (2012-12-14 13:48)

  • CMake clean up

1.5.6 (2012-12-10)

  • Removed vestigial manifest.xml

1.5.5 (2012-11-15)

  • Added .count field (of 1) to every PointCloud2 field description. This fixes the bug referred to here: http://dev.pointclouds.org/issues/821 which is useful because that fix in PCL seems not to be released yet. Also this way is more correct, as far as I can tell.
  • Tidied up CMakeLists.txt based on Dirk\'s recommendations.

1.5.4 (2012-10-10)

  • added install rules to CMakeLists.txt needed for catkinization.
  • catkinized

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged laser_geometry at Robotics Stack Exchange

laser_geometry package from laser_geometry repo

laser_geometry

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/laser_geometry.git
VCS Type git
VCS Version indigo-devel
Last Updated 2019-10-23
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

This package contains a class for converting from a 2D laser scan as defined by sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud or sensor_msgs/PointCloud2. In particular, it contains functionality to account for the skew resulting from moving robots or tilting laser scanners.

Additional Links

Maintainers

  • Dave Hershberger
  • William Woodall

Authors

  • Tully Foote
  • Radu Bogdan Rusu
README
No README found. No README in repository either.
CHANGELOG

Changelog for package laser_geometry

1.6.4 (2015-05-18)

  • Fix segfault when laserscan ranges[] is empty
  • Contributors: Timm Linder, Vincent Rabaud

1.6.3 (2015-03-07)

  • provide support for tf2
  • Contributors: Vincent Rabaud

1.6.2 (2014-06-08)

  • adds python port (only simple projection)
  • allows to have range_cutoff > range_max NOTE this is required if we need to keep the range_max readings in the point cloud. An example application is an obstacle_layer in a costmap.
  • Contributors: Vincent Rabaud, enriquefernandez

1.6.1 (2014-02-23)

  • Added dependency on cmake_modules
  • Contributors: William Woodall

1.6.0 (2014-02-21)

  • Adding William Woodall as a co-maintainer
  • Contributors: Vincent Rabaud, William Woodall

1.5.15 (2013-12-02)

  • Fix mistake in end_time calculation for scan transformation in #6

1.5.14 (2013-11-04)

  • Treat max_range as invalid measurement
  • Properly propagate range_cutoff
  • check for CATKIN_ENABLE_TESTING

1.5.13 (2013-10-06)

  • fixes #3

1.5.12 (2013-09-14)

  • fix case of Eigen find_package name

1.5.11 (2013-07-01)

  • added missing run deps

1.5.10 (2013-06-28 15:09)

  • [bugfix] export boost and eigen via DEPENDS

1.5.9 (2013-06-28 11:38)

  • [bugfix] export boost and eigen include dirs

1.5.8 (2012-12-14 13:54)

  • Added buildtool_depend on catkin

1.5.7 (2012-12-14 13:48)

  • CMake clean up

1.5.6 (2012-12-10)

  • Removed vestigial manifest.xml

1.5.5 (2012-11-15)

  • Added .count field (of 1) to every PointCloud2 field description. This fixes the bug referred to here: http://dev.pointclouds.org/issues/821 which is useful because that fix in PCL seems not to be released yet. Also this way is more correct, as far as I can tell.
  • Tidied up CMakeLists.txt based on Dirk\'s recommendations.

1.5.4 (2012-10-10)

  • added install rules to CMakeLists.txt needed for catkinization.
  • catkinized

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged laser_geometry at Robotics Stack Exchange

laser_geometry package from laser_geometry repo

laser_geometry

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/laser_geometry.git
VCS Type git
VCS Version indigo-devel
Last Updated 2019-10-23
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

This package contains a class for converting from a 2D laser scan as defined by sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud or sensor_msgs/PointCloud2. In particular, it contains functionality to account for the skew resulting from moving robots or tilting laser scanners.

Additional Links

Maintainers

  • Dave Hershberger
  • William Woodall

Authors

  • Tully Foote
  • Radu Bogdan Rusu
README
No README found. No README in repository either.
CHANGELOG

Changelog for package laser_geometry

1.6.4 (2015-05-18)

  • Fix segfault when laserscan ranges[] is empty
  • Contributors: Timm Linder, Vincent Rabaud

1.6.3 (2015-03-07)

  • provide support for tf2
  • Contributors: Vincent Rabaud

1.6.2 (2014-06-08)

  • adds python port (only simple projection)
  • allows to have range_cutoff > range_max NOTE this is required if we need to keep the range_max readings in the point cloud. An example application is an obstacle_layer in a costmap.
  • Contributors: Vincent Rabaud, enriquefernandez

1.6.1 (2014-02-23)

  • Added dependency on cmake_modules
  • Contributors: William Woodall

1.6.0 (2014-02-21)

  • Adding William Woodall as a co-maintainer
  • Contributors: Vincent Rabaud, William Woodall

1.5.15 (2013-12-02)

  • Fix mistake in end_time calculation for scan transformation in #6

1.5.14 (2013-11-04)

  • Treat max_range as invalid measurement
  • Properly propagate range_cutoff
  • check for CATKIN_ENABLE_TESTING

1.5.13 (2013-10-06)

  • fixes #3

1.5.12 (2013-09-14)

  • fix case of Eigen find_package name

1.5.11 (2013-07-01)

  • added missing run deps

1.5.10 (2013-06-28 15:09)

  • [bugfix] export boost and eigen via DEPENDS

1.5.9 (2013-06-28 11:38)

  • [bugfix] export boost and eigen include dirs

1.5.8 (2012-12-14 13:54)

  • Added buildtool_depend on catkin

1.5.7 (2012-12-14 13:48)

  • CMake clean up

1.5.6 (2012-12-10)

  • Removed vestigial manifest.xml

1.5.5 (2012-11-15)

  • Added .count field (of 1) to every PointCloud2 field description. This fixes the bug referred to here: http://dev.pointclouds.org/issues/821 which is useful because that fix in PCL seems not to be released yet. Also this way is more correct, as far as I can tell.
  • Tidied up CMakeLists.txt based on Dirk\'s recommendations.

1.5.4 (2012-10-10)

  • added install rules to CMakeLists.txt needed for catkinization.
  • catkinized

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged laser_geometry at Robotics Stack Exchange

laser_geometry package from laser_geometry repo

laser_geometry

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/laser_geometry.git
VCS Type git
VCS Version hydro-devel
Last Updated 2014-06-08
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

This package contains a class for converting from a 2D laser scan as defined by sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud or sensor_msgs/PointCloud2. In particular, it contains functionality to account for the skew resulting from moving robots or tilting laser scanners.

Additional Links

Maintainers

  • Dave Hershberger

Authors

  • Tully Foote
  • Radu Bogdan Rusu
README
No README found. No README in repository either.
CHANGELOG

Changelog for package laser_geometry

1.5.16 (2014-06-08)

  • allows to have range_cutoff > range_max NOTE this is required if we need to keep the range_max readings in the point cloud. An example application is an obstacle_layer in a costmap.
  • adds python port (only simple projection)
  • Contributors: Vincent Rabaud, enriquefernandez

1.5.15 (2013-12-02)

  • Fix mistake in end_time calculation for scan transformation in #6

1.5.14 (2013-11-04)

  • Treat max_range as invalid measurement
  • Properly propagate range_cutoff
  • check for CATKIN_ENABLE_TESTING

1.5.13 (2013-10-06)

  • fixes #3

1.5.12 (2013-09-14)

  • fix case of Eigen find_package name

1.5.11 (2013-07-01)

  • added missing run deps

1.5.10 (2013-06-28 15:09)

  • [bugfix] export boost and eigen via DEPENDS

1.5.9 (2013-06-28 11:38)

  • [bugfix] export boost and eigen include dirs

1.5.8 (2012-12-14 13:54)

  • Added buildtool_depend on catkin

1.5.7 (2012-12-14 13:48)

  • CMake clean up

1.5.6 (2012-12-10)

  • Removed vestigial manifest.xml

1.5.5 (2012-11-15)

  • Added .count field (of 1) to every PointCloud2 field description. This fixes the bug referred to here: http://dev.pointclouds.org/issues/821 which is useful because that fix in PCL seems not to be released yet. Also this way is more correct, as far as I can tell.
  • Tidied up CMakeLists.txt based on Dirk\'s recommendations.

1.5.4 (2012-10-10)

  • added install rules to CMakeLists.txt needed for catkinization.
  • catkinized

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged laser_geometry at Robotics Stack Exchange

laser_geometry package from laser_geometry repo

laser_geometry

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/laser_geometry.git
VCS Type git
VCS Version kinetic-devel
Last Updated 2022-08-19
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

This package contains a class for converting from a 2D laser scan as defined by sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud or sensor_msgs/PointCloud2. In particular, it contains functionality to account for the skew resulting from moving robots or tilting laser scanners.

Additional Links

Maintainers

  • Dave Hershberger
  • Mabel Zhang

Authors

  • Tully Foote
  • Radu Bogdan Rusu
  • William Woodall
README
No README found. No README in repository either.
CHANGELOG

Changelog for package laser_geometry

1.6.7 (2021-02-05)

  • Require C++11
  • Contributors: Mabel Zhang, Martin Pecka

1.6.6 (2021-01-14)

  • Handle FindEigen3 module\'s differing definitions, define [EIGEN3_INCLUDE_DIRS]{.title-ref} with [EIGEN3_INCLUDE_DIR]{.title-ref}.
  • update maintainers
  • Added transformLaserScanToPointCloud() version utilizing fixed frame.
  • Contributors: Jonathan Binney, Mabel Zhang, Martin Pecka, Scott K Logan

1.6.5 (2020-03-13)

  • Bump CMake version to avoid CMP0048
  • Update package.xml to schema version 3
  • Choose python version based on what ros is using
  • Make rostest headers available to projection_test
  • Remove unneeded time header - it was breaking windows builds.
  • add DLL import/export macro
  • export dll on Windows
  • rename visibility macro
  • windows bringup
  • extend CMake install targets
  • Add dependency on tf2 for downstream packages
  • Update and fix package.xml Eigen dependency
  • Export Eigen dependency
  • Create LICENSE
  • Better use of numpy
  • Contributors: Eric Wieser, James Xu, Jochen Sprickerhof, Jon Binney, Jonathan Binney, Scott K Logan, Shane Loretz, Tully Foote, Vincent Rabaud, William Woodall

1.6.4 (2015-05-18)

  • Fix segfault when laserscan ranges[] is empty
  • Contributors: Timm Linder, Vincent Rabaud

1.6.3 (2015-03-07)

  • provide support for tf2
  • Contributors: Vincent Rabaud

1.6.2 (2014-06-08)

  • adds python port (only simple projection)
  • allows to have range_cutoff > range_max NOTE this is required if we need to keep the range_max readings in the point cloud. An example application is an obstacle_layer in a costmap.
  • Contributors: Vincent Rabaud, enriquefernandez

1.6.1 (2014-02-23)

  • Added dependency on cmake_modules
  • Contributors: William Woodall

1.6.0 (2014-02-21)

  • Adding William Woodall as a co-maintainer
  • Contributors: Vincent Rabaud, William Woodall

1.5.15 (2013-12-02)

  • Fix mistake in end_time calculation for scan transformation in #6

1.5.14 (2013-11-04)

  • Treat max_range as invalid measurement
  • Properly propagate range_cutoff
  • check for CATKIN_ENABLE_TESTING

1.5.13 (2013-10-06)

  • fixes #3

1.5.12 (2013-09-14)

  • fix case of Eigen find_package name

1.5.11 (2013-07-01)

  • added missing run deps

1.5.10 (2013-06-28 15:09)

  • [bugfix] export boost and eigen via DEPENDS

1.5.9 (2013-06-28 11:38)

  • [bugfix] export boost and eigen include dirs

1.5.8 (2012-12-14 13:54)

  • Added buildtool_depend on catkin

1.5.7 (2012-12-14 13:48)

  • CMake clean up

1.5.6 (2012-12-10)

  • Removed vestigial manifest.xml

1.5.5 (2012-11-15)

  • Added .count field (of 1) to every PointCloud2 field description. This fixes the bug referred to here: http://dev.pointclouds.org/issues/821 which is useful because that fix in PCL seems not to be released yet. Also this way is more correct, as far as I can tell.
  • Tidied up CMakeLists.txt based on Dirk\'s recommendations.

1.5.4 (2012-10-10)

  • added install rules to CMakeLists.txt needed for catkinization.
  • catkinized

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged laser_geometry at Robotics Stack Exchange

laser_geometry package from laser_geometry repo

laser_geometry

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/laser_geometry.git
VCS Type git
VCS Version kinetic-devel
Last Updated 2022-08-19
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

This package contains a class for converting from a 2D laser scan as defined by sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud or sensor_msgs/PointCloud2. In particular, it contains functionality to account for the skew resulting from moving robots or tilting laser scanners.

Additional Links

Maintainers

  • Dave Hershberger
  • Mabel Zhang

Authors

  • Tully Foote
  • Radu Bogdan Rusu
  • William Woodall
README
No README found. No README in repository either.
CHANGELOG

Changelog for package laser_geometry

1.6.7 (2021-02-05)

  • Require C++11
  • Contributors: Mabel Zhang, Martin Pecka

1.6.6 (2021-01-14)

  • Handle FindEigen3 module\'s differing definitions, define [EIGEN3_INCLUDE_DIRS]{.title-ref} with [EIGEN3_INCLUDE_DIR]{.title-ref}.
  • update maintainers
  • Added transformLaserScanToPointCloud() version utilizing fixed frame.
  • Contributors: Jonathan Binney, Mabel Zhang, Martin Pecka, Scott K Logan

1.6.5 (2020-03-13)

  • Bump CMake version to avoid CMP0048
  • Update package.xml to schema version 3
  • Choose python version based on what ros is using
  • Make rostest headers available to projection_test
  • Remove unneeded time header - it was breaking windows builds.
  • add DLL import/export macro
  • export dll on Windows
  • rename visibility macro
  • windows bringup
  • extend CMake install targets
  • Add dependency on tf2 for downstream packages
  • Update and fix package.xml Eigen dependency
  • Export Eigen dependency
  • Create LICENSE
  • Better use of numpy
  • Contributors: Eric Wieser, James Xu, Jochen Sprickerhof, Jon Binney, Jonathan Binney, Scott K Logan, Shane Loretz, Tully Foote, Vincent Rabaud, William Woodall

1.6.4 (2015-05-18)

  • Fix segfault when laserscan ranges[] is empty
  • Contributors: Timm Linder, Vincent Rabaud

1.6.3 (2015-03-07)

  • provide support for tf2
  • Contributors: Vincent Rabaud

1.6.2 (2014-06-08)

  • adds python port (only simple projection)
  • allows to have range_cutoff > range_max NOTE this is required if we need to keep the range_max readings in the point cloud. An example application is an obstacle_layer in a costmap.
  • Contributors: Vincent Rabaud, enriquefernandez

1.6.1 (2014-02-23)

  • Added dependency on cmake_modules
  • Contributors: William Woodall

1.6.0 (2014-02-21)

  • Adding William Woodall as a co-maintainer
  • Contributors: Vincent Rabaud, William Woodall

1.5.15 (2013-12-02)

  • Fix mistake in end_time calculation for scan transformation in #6

1.5.14 (2013-11-04)

  • Treat max_range as invalid measurement
  • Properly propagate range_cutoff
  • check for CATKIN_ENABLE_TESTING

1.5.13 (2013-10-06)

  • fixes #3

1.5.12 (2013-09-14)

  • fix case of Eigen find_package name

1.5.11 (2013-07-01)

  • added missing run deps

1.5.10 (2013-06-28 15:09)

  • [bugfix] export boost and eigen via DEPENDS

1.5.9 (2013-06-28 11:38)

  • [bugfix] export boost and eigen include dirs

1.5.8 (2012-12-14 13:54)

  • Added buildtool_depend on catkin

1.5.7 (2012-12-14 13:48)

  • CMake clean up

1.5.6 (2012-12-10)

  • Removed vestigial manifest.xml

1.5.5 (2012-11-15)

  • Added .count field (of 1) to every PointCloud2 field description. This fixes the bug referred to here: http://dev.pointclouds.org/issues/821 which is useful because that fix in PCL seems not to be released yet. Also this way is more correct, as far as I can tell.
  • Tidied up CMakeLists.txt based on Dirk\'s recommendations.

1.5.4 (2012-10-10)

  • added install rules to CMakeLists.txt needed for catkinization.
  • catkinized

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged laser_geometry at Robotics Stack Exchange