- Deprecating tf2 C Headers (#98)
- Remove CODEOWNERS and mirror-rolling-to-main workflow (#100)
- Contributors: Alejandro Hernández Cordero, Lucas Wendland
- Stop using python_cmake_module. (#93)
- Contributors: Chris Lalancette
- Added common linters (#96)
- Contributors: Alejandro Hernández Cordero
- Switch to target_link_libraries. (#92)
- Contributors: Chris Lalancette
- Update laser_geometry to C++17. (#90)
- Update Maintainers (#88)
- Mirror rolling to ros2
- Contributors: Audrow Nash, Chris Lalancette
- 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
- Fix building on running on Windows Debug (#82)
- Update python code and tests for ros2 (#80)
- Contributors: Chris Lalancette, Jonathan Binney
- Export sensor_msgs, tf2, and rclcpp as dependencies
- Contributors: Mabel Zhang, Michel Hidalgo
- Use rclcpp::Duration::from_seconds (#72)
- update maintainers
- increase test timeout
- Contributors: Dirk Thomas, Ivan Santiago Paunovic, Jonathan Binney, Mabel Zhang
- 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
- Merge pull request #46 from sloretz/eigen3_cmake_module
- Contributors: Jonathan Binney, Shane Loretz
- 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
- Fix segfault when laserscan ranges[] is empty
- Contributors: Timm Linder, Vincent Rabaud
- provide support for tf2
- Contributors: Vincent Rabaud
- 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
- Added dependency on cmake_modules
- Contributors: William Woodall
- Adding William Woodall as a co-maintainer
- Contributors: Vincent Rabaud, William Woodall
- Fix mistake in end_time calculation for scan transformation in #6
- Treat max_range as invalid measurement
- Properly propagate range_cutoff
- check for CATKIN_ENABLE_TESTING
- fixes #3
- fix case of Eigen find_package name
- added missing run deps
- [bugfix] export boost and eigen via DEPENDS
- [bugfix] export boost and eigen include dirs
- Added buildtool_depend on catkin
- CMake clean up
- Removed vestigial manifest.xml
- 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.
- added install rules to CMakeLists.txt needed for catkinization.
- catkinized