- feat: use exported targets (#69)
- Stop using the deprecated tf2_sensor_msgs.h header. (#73)
- Fix default parameters in README (#65)
- fix: update static transfrom publisher arguments (#70)
- Cleanup CMakeLists.txt with ament_cmake_auto (#57)
- Add BSD-3 clause LICENSE
- Contributors: Carlos Andrés Álvarez Restrepo, Chris Lalancette, Daisuke Nishimatsu, Michel Hidalgo
- Replace deprecated launch api (#56)
- Fix linting errors in the code (#52)
- Update README.md
- Contributors: Chris Lalancette, Daisuke Nishimatsu, Paul Bovbel
- ROS 2 Migration (#33) * ROS 2 Migration Signed-off-by: Michel Hidalgo <[email protected]>
- Contributors: Michel Hidalgo
- LaserScan to PointCloud node + nodelet (#28)
- fix roslint (#29)
- Merge pull request #20 from ros-perception/range_max_check Add check for range_max
- Add check for range_max
- Contributors: Paul Bovbel, Rein Appeldoorn
- Added inf_epsilon parameter that determines the value added to max range when use_infs parameter is set to false
- Merge pull request #11 from ros-perception/mikaelarguedas-patch-1 update to use non deprecated pluginlib macro
- Migrate to package format 2; add roslint
- Add sane parameter defaults; fixup lint warnings
- update to use non deprecated pluginlib macro
- Contributors: Mikael Arguedas, Paul Bovbel, Prasanna Kannappan
- Merge pull request #4 from yoshimalucky/fix-miscalculation-in-angle-increment Fixed miscalculation in angle_increment in the launch files.
- fixed miscalculation in angle_increment in the launchfiles.
- Contributors: Paul Bovbel, yoshimalucky
- Fix pointcloud to laserscan transform tolerance issues
- Move pointcloud_to_laserscan to new repository
- Contributors: Paul Bovbel
- Cleanup pointcloud_to_laserscan launch files
- Contributors: Paul Bovbel
- Fix default value for concurrency
- Fix multithreaded lazy pub sub
- Contributors: Paul Bovbel
- Switch to tf_sensor_msgs for transform
- Set parameters in sample launch files to default
- Add tolerance parameter
- Contributors: Paul Bovbel
- Remove stray dependencies
- Refactor with tf2 and message filters
- Remove roslaunch check
- Fix regressions
- Refactor to allow debug messages from node and nodelet
- Contributors: Paul Bovbel
- add launch tests
- refactor naming and fix nodelet export
- set default target frame to empty
- clean up package.xml
- Contributors: Paul Bovbel
- clean up package.xml
- Fix header reference
- Fix flow
- Fix pointer assertion
- Finalize pointcloud to laserscan
- Initial pointcloud to laserscan commit
- Contributors: Paul Bovbel