pointcloud_to_laserscan package from pointcloud_to_laserscan repo

pointcloud_to_laserscan

Package Summary

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

Repository Summary

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

Converts a 3D Point Cloud into a 2D laser scan. This is useful for making devices like the Kinect appear like a laser scanner for 2D-based algorithms (e.g. laser-based SLAM).

Additional Links

Maintainers

  • Paul Bovbel
  • Michel Hidalgo

Authors

  • Paul Bovbel
  • Michel Hidalgo
  • Tully Foote

ROS 2 pointcloud <-> laserscan converters

This is a ROS 2 package that provides components to convert sensor_msgs/msg/PointCloud2 messages to sensor_msgs/msg/LaserScan messages and back. It is essentially a port of the original ROS 1 package.

pointcloud_to_laserscan::PointCloudToLaserScanNode

This ROS 2 component projects sensor_msgs/msg/PointCloud2 messages into sensor_msgs/msg/LaserScan messages.

Published Topics

  • scan (sensor_msgs/msg/LaserScan) - The output laser scan.

Subscribed Topics

  • cloud_in (sensor_msgs/msg/PointCloud2) - The input point cloud. No input will be processed if there isn't at least one subscriber to the scan topic.

Parameters

  • min_height (double, default: 2.2e-308) - The minimum height to sample in the point cloud in meters.
  • max_height (double, default: 1.8e+308) - The maximum height to sample in the point cloud in meters.
  • angle_min (double, default: -π) - The minimum scan angle in radians.
  • angle_max (double, default: π) - The maximum scan angle in radians.
  • angle_increment (double, default: π/180) - Resolution of laser scan in radians per ray.
  • queue_size (double, default: detected number of cores) - Input point cloud queue size.
  • scan_time (double, default: 1.0/30.0) - The scan rate in seconds. Only used to populate the scan_time field of the output laser scan message.
  • range_min (double, default: 0.0) - The minimum ranges to return in meters.
  • range_max (double, default: 1.8e+308) - The maximum ranges to return in meters.
  • target_frame (str, default: none) - If provided, transform the pointcloud into this frame before converting to a laser scan. Otherwise, laser scan will be generated in the same frame as the input point cloud.
  • transform_tolerance (double, default: 0.01) - Time tolerance for transform lookups. Only used if a target_frame is provided.
  • use_inf (boolean, default: true) - If disabled, report infinite range (no obstacle) as range_max + 1. Otherwise report infinite range as +inf.

pointcloud_to_laserscan::LaserScanToPointCloudNode

This ROS 2 component re-publishes sensor_msgs/msg/LaserScan messages as sensor_msgs/msg/PointCloud2 messages.

Published Topics

  • cloud (sensor_msgs/msg/PointCloud2) - The output point cloud.

Subscribed Topics

  • scan_in (sensor_msgs/msg/LaserScan) - The input laser scan. No input will be processed if there isn't at least one subscriber to the cloud topic.

Parameters

  • queue_size (double, default: detected number of cores) - Input laser scan queue size.
  • target_frame (str, default: none) - If provided, transform the pointcloud into this frame before converting to a laser scan. Otherwise, laser scan will be generated in the same frame as the input point cloud.
  • transform_tolerance (double, default: 0.01) - Time tolerance for transform lookups. Only used if a target_frame is provided.
CHANGELOG

Changelog for package pointcloud_to_laserscan

2.0.1 (2021-10-19)

  • Replace deprecated launch api (#56)
  • Fix linting errors in the code (#52)
  • Update README.md
  • Contributors: Chris Lalancette, Daisuke Nishimatsu, Paul Bovbel

2.0.0 (2020-02-10)

  • ROS 2 Migration (#33) * ROS 2 Migration Signed-off-by: Michel Hidalgo <michel@ekumenlabs.com>

  • Contributors: Michel Hidalgo

1.4.1 (2019-08-30)

  • 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

1.4.0 (2017-11-14)

  • 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

1.3.1 (2017-04-26)

  • 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

1.3.0 (2015-06-09)

  • Fix pointcloud to laserscan transform tolerance issues
  • Move pointcloud_to_laserscan to new repository
  • Contributors: Paul Bovbel

1.2.7 (2015-06-08)

  • Cleanup pointcloud_to_laserscan launch files
  • Contributors: Paul Bovbel

1.2.6 (2015-02-04)

  • Fix default value for concurrency
  • Fix multithreaded lazy pub sub
  • Contributors: Paul Bovbel

1.2.5 (2015-01-20)

  • Switch to tf_sensor_msgs for transform
  • Set parameters in sample launch files to default
  • Add tolerance parameter
  • Contributors: Paul Bovbel

1.2.4 (2015-01-15)

  • 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

1.2.3 (2015-01-10)

  • add launch tests
  • refactor naming and fix nodelet export
  • set default target frame to empty
  • clean up package.xml
  • Contributors: Paul Bovbel

1.2.2 (2014-10-25)

  • clean up package.xml
  • Fix header reference
  • Fix flow
  • Fix pointer assertion
  • Finalize pointcloud to laserscan
  • Initial pointcloud to laserscan commit
  • Contributors: Paul Bovbel

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 pointcloud_to_laserscan at Robotics Stack Exchange

pointcloud_to_laserscan package from pointcloud_to_laserscan repo

pointcloud_to_laserscan

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/pointcloud_to_laserscan.git
VCS Type git
VCS Version rolling
Last Updated 2024-02-16
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

Converts a 3D Point Cloud into a 2D laser scan. This is useful for making devices like the Kinect appear like a laser scanner for 2D-based algorithms (e.g. laser-based SLAM).

Additional Links

Maintainers

  • Paul Bovbel
  • Michel Hidalgo

Authors

  • Paul Bovbel
  • Michel Hidalgo
  • Tully Foote

ROS 2 pointcloud <-> laserscan converters

This is a ROS 2 package that provides components to convert sensor_msgs/msg/PointCloud2 messages to sensor_msgs/msg/LaserScan messages and back. It is essentially a port of the original ROS 1 package.

pointcloud_to_laserscan::PointCloudToLaserScanNode

This ROS 2 component projects sensor_msgs/msg/PointCloud2 messages into sensor_msgs/msg/LaserScan messages.

Published Topics

  • scan (sensor_msgs/msg/LaserScan) - The output laser scan.

Subscribed Topics

  • cloud_in (sensor_msgs/msg/PointCloud2) - The input point cloud. No input will be processed if there isn't at least one subscriber to the scan topic.

Parameters

  • min_height (double, default: 2.2e-308) - The minimum height to sample in the point cloud in meters.
  • max_height (double, default: 1.8e+308) - The maximum height to sample in the point cloud in meters.
  • angle_min (double, default: -π) - The minimum scan angle in radians.
  • angle_max (double, default: π) - The maximum scan angle in radians.
  • angle_increment (double, default: π/180) - Resolution of laser scan in radians per ray.
  • queue_size (double, default: detected number of cores) - Input point cloud queue size.
  • scan_time (double, default: 1.0/30.0) - The scan rate in seconds. Only used to populate the scan_time field of the output laser scan message.
  • range_min (double, default: 0.0) - The minimum ranges to return in meters.
  • range_max (double, default: 1.8e+308) - The maximum ranges to return in meters.
  • target_frame (str, default: none) - If provided, transform the pointcloud into this frame before converting to a laser scan. Otherwise, laser scan will be generated in the same frame as the input point cloud.
  • transform_tolerance (double, default: 0.01) - Time tolerance for transform lookups. Only used if a target_frame is provided.
  • use_inf (boolean, default: true) - If disabled, report infinite range (no obstacle) as range_max + 1. Otherwise report infinite range as +inf.

pointcloud_to_laserscan::LaserScanToPointCloudNode

This ROS 2 component re-publishes sensor_msgs/msg/LaserScan messages as sensor_msgs/msg/PointCloud2 messages.

Published Topics

  • cloud (sensor_msgs/msg/PointCloud2) - The output point cloud.

Subscribed Topics

  • scan_in (sensor_msgs/msg/LaserScan) - The input laser scan. No input will be processed if there isn't at least one subscriber to the cloud topic.

Parameters

  • queue_size (double, default: detected number of cores) - Input laser scan queue size.
  • target_frame (str, default: none) - If provided, transform the pointcloud into this frame before converting to a laser scan. Otherwise, laser scan will be generated in the same frame as the input point cloud.
  • transform_tolerance (double, default: 0.01) - Time tolerance for transform lookups. Only used if a target_frame is provided.
CHANGELOG

Changelog for package pointcloud_to_laserscan

2.0.2 (2024-02-16)

  • 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

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 pointcloud_to_laserscan at Robotics Stack Exchange

pointcloud_to_laserscan package from pointcloud_to_laserscan repo

pointcloud_to_laserscan

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/pointcloud_to_laserscan.git
VCS Type git
VCS Version rolling
Last Updated 2024-02-16
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

Converts a 3D Point Cloud into a 2D laser scan. This is useful for making devices like the Kinect appear like a laser scanner for 2D-based algorithms (e.g. laser-based SLAM).

Additional Links

Maintainers

  • Paul Bovbel
  • Michel Hidalgo

Authors

  • Paul Bovbel
  • Michel Hidalgo
  • Tully Foote

ROS 2 pointcloud <-> laserscan converters

This is a ROS 2 package that provides components to convert sensor_msgs/msg/PointCloud2 messages to sensor_msgs/msg/LaserScan messages and back. It is essentially a port of the original ROS 1 package.

pointcloud_to_laserscan::PointCloudToLaserScanNode

This ROS 2 component projects sensor_msgs/msg/PointCloud2 messages into sensor_msgs/msg/LaserScan messages.

Published Topics

  • scan (sensor_msgs/msg/LaserScan) - The output laser scan.

Subscribed Topics

  • cloud_in (sensor_msgs/msg/PointCloud2) - The input point cloud. No input will be processed if there isn't at least one subscriber to the scan topic.

Parameters

  • min_height (double, default: 2.2e-308) - The minimum height to sample in the point cloud in meters.
  • max_height (double, default: 1.8e+308) - The maximum height to sample in the point cloud in meters.
  • angle_min (double, default: -π) - The minimum scan angle in radians.
  • angle_max (double, default: π) - The maximum scan angle in radians.
  • angle_increment (double, default: π/180) - Resolution of laser scan in radians per ray.
  • queue_size (double, default: detected number of cores) - Input point cloud queue size.
  • scan_time (double, default: 1.0/30.0) - The scan rate in seconds. Only used to populate the scan_time field of the output laser scan message.
  • range_min (double, default: 0.0) - The minimum ranges to return in meters.
  • range_max (double, default: 1.8e+308) - The maximum ranges to return in meters.
  • target_frame (str, default: none) - If provided, transform the pointcloud into this frame before converting to a laser scan. Otherwise, laser scan will be generated in the same frame as the input point cloud.
  • transform_tolerance (double, default: 0.01) - Time tolerance for transform lookups. Only used if a target_frame is provided.
  • use_inf (boolean, default: true) - If disabled, report infinite range (no obstacle) as range_max + 1. Otherwise report infinite range as +inf.

pointcloud_to_laserscan::LaserScanToPointCloudNode

This ROS 2 component re-publishes sensor_msgs/msg/LaserScan messages as sensor_msgs/msg/PointCloud2 messages.

Published Topics

  • cloud (sensor_msgs/msg/PointCloud2) - The output point cloud.

Subscribed Topics

  • scan_in (sensor_msgs/msg/LaserScan) - The input laser scan. No input will be processed if there isn't at least one subscriber to the cloud topic.

Parameters

  • queue_size (double, default: detected number of cores) - Input laser scan queue size.
  • target_frame (str, default: none) - If provided, transform the pointcloud into this frame before converting to a laser scan. Otherwise, laser scan will be generated in the same frame as the input point cloud.
  • transform_tolerance (double, default: 0.01) - Time tolerance for transform lookups. Only used if a target_frame is provided.
CHANGELOG

Changelog for package pointcloud_to_laserscan

2.0.2 (2024-02-16)

  • 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

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 pointcloud_to_laserscan at Robotics Stack Exchange

pointcloud_to_laserscan package from pointcloud_to_laserscan repo

pointcloud_to_laserscan

Package Summary

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

Repository Summary

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

Converts a 3D Point Cloud into a 2D laser scan. This is useful for making devices like the Kinect appear like a laser scanner for 2D-based algorithms (e.g. laser-based SLAM).

Additional Links

Maintainers

  • Paul Bovbel
  • Michel Hidalgo

Authors

  • Paul Bovbel
  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package pointcloud_to_laserscan

1.4.1 (2019-08-30)

  • 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

1.4.0 (2017-11-14)

  • 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

1.3.1 (2017-04-26)

  • 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

1.3.0 (2015-06-09)

  • Fix pointcloud to laserscan transform tolerance issues
  • Move pointcloud_to_laserscan to new repository
  • Contributors: Paul Bovbel

1.2.7 (2015-06-08)

  • Cleanup pointcloud_to_laserscan launch files
  • Contributors: Paul Bovbel

1.2.6 (2015-02-04)

  • Fix default value for concurrency
  • Fix multithreaded lazy pub sub
  • Contributors: Paul Bovbel

1.2.5 (2015-01-20)

  • Switch to tf_sensor_msgs for transform
  • Set parameters in sample launch files to default
  • Add tolerance parameter
  • Contributors: Paul Bovbel

1.2.4 (2015-01-15)

  • 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

1.2.3 (2015-01-10)

  • add launch tests
  • refactor naming and fix nodelet export
  • set default target frame to empty
  • clean up package.xml
  • Contributors: Paul Bovbel

1.2.2 (2014-10-25)

  • clean up package.xml
  • Fix header reference
  • Fix flow
  • Fix pointer assertion
  • Finalize pointcloud to laserscan
  • Initial pointcloud to laserscan commit
  • Contributors: Paul Bovbel

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

Messages

No message files found.

Services

No service files found

Plugins

Recent questions tagged pointcloud_to_laserscan at Robotics Stack Exchange

No version for distro ardent. Known supported distros are highlighted in the buttons above.
No version for distro bouncy. Known supported distros are highlighted in the buttons above.
No version for distro crystal. Known supported distros are highlighted in the buttons above.

pointcloud_to_laserscan package from pointcloud_to_laserscan repo

pointcloud_to_laserscan

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/pointcloud_to_laserscan.git
VCS Type git
VCS Version eloquent-devel
Last Updated 2020-02-10
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

Converts a 3D Point Cloud into a 2D laser scan. This is useful for making devices like the Kinect appear like a laser scanner for 2D-based algorithms (e.g. laser-based SLAM).

Additional Links

Maintainers

  • Paul Bovbel
  • Michel Hidalgo

Authors

  • Paul Bovbel
  • Michel Hidalgo
  • Tully Foote

ROS 2 pointcloud <-> laserscan converters

This is a ROS 2 package that provides components to convert sensor_msgs/msg/PointCloud2 messages to sensor_msgs/msg/LaserScan messages and back. It is essentially a port of the original ROS 1 package.

pointcloud_to_laserscan::PointCloudToLaserScanNode

This ROS 2 component projects sensor_msgs/msg/PointCloud2 messages into sensor_msgs/msg/LaserScan messages.

Published Topics

  • scan (sensor_msgs/msg/LaserScan) - The output laser scan.

Subscribed Topics

  • cloud_in (sensor_msgs/msg/PointCloud2) - The input point cloud. No input will be processed if there isn't at least one subscriber to the scan topic.

Parameters

  • min_height (double, default: 0.0) - The minimum height to sample in the point cloud in meters.
  • max_height (double, default: 1.0) - The maximum height to sample in the point cloud in meters.
  • angle_min (double, default: -π/2) - The minimum scan angle in radians.
  • angle_max (double, default: π/2) - The maximum scan angle in radians.
  • angle_increment (double, default: π/360) - Resolution of laser scan in radians per ray.
  • queue_size (double, default: detected number of cores) - Input point cloud queue size.
  • scan_time (double, default: 1.0/30.0) - The scan rate in seconds. Used to populate the output laser scan.
  • range_min (double, default: 0.45) - The minimum ranges to return in meters.
  • range_max (double, default: 4.0) - The maximum ranges to return in meters.
  • target_frame (str, default: none) - If provided, transform the pointcloud into this frame before converting to a laser scan. Otherwise, laser scan will be generated in the same frame as the input point cloud.
  • transform_tolerance (double, default: 0.01) - Time tolerance for transform lookups. Only used if a target_frame is provided.
  • use_inf (boolean, default: true) - If disabled, report infinite range (no obstacle) as range_max + 1. Otherwise report infinite range as +inf.

pointcloud_to_laserscan::LaserScanToPointCloudNode

This ROS 2 component re-publishes sensor_msgs/msg/LaserScan messages as sensor_msgs/msg/PointCloud2 messages.

Published Topics

  • cloud (sensor_msgs/msg/PointCloud2) - The output point cloud.

Subscribed Topics

  • scan_in (sensor_msgs/msg/LaserScan) - The input laser scan. No input will be processed if there isn't at least one subscriber to the cloud topic.

Parameters

  • queue_size (double, default: detected number of cores) - Input laser scan queue size.
  • target_frame (str, default: none) - If provided, transform the pointcloud into this frame before converting to a laser scan. Otherwise, laser scan will be generated in the same frame as the input point cloud.
  • transform_tolerance (double, default: 0.01) - Time tolerance for transform lookups. Only used if a target_frame is provided.
  • use_inf (boolean, default: true) - If disabled, report infinite range (no obstacle) as range_max + 1. Otherwise report infinite range as +inf.
CHANGELOG

Changelog for package pointcloud_to_laserscan

2.0.0 (2020-02-10)

  • ROS 2 Migration (#33) * ROS 2 Migration Signed-off-by: Michel Hidalgo <michel@ekumenlabs.com>

  • Contributors: Michel Hidalgo

1.4.1 (2019-08-30)

  • 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

1.4.0 (2017-11-14)

  • 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

1.3.1 (2017-04-26)

  • 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

1.3.0 (2015-06-09)

  • Fix pointcloud to laserscan transform tolerance issues
  • Move pointcloud_to_laserscan to new repository
  • Contributors: Paul Bovbel

1.2.7 (2015-06-08)

  • Cleanup pointcloud_to_laserscan launch files
  • Contributors: Paul Bovbel

1.2.6 (2015-02-04)

  • Fix default value for concurrency
  • Fix multithreaded lazy pub sub
  • Contributors: Paul Bovbel

1.2.5 (2015-01-20)

  • Switch to tf_sensor_msgs for transform
  • Set parameters in sample launch files to default
  • Add tolerance parameter
  • Contributors: Paul Bovbel

1.2.4 (2015-01-15)

  • 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

1.2.3 (2015-01-10)

  • add launch tests
  • refactor naming and fix nodelet export
  • set default target frame to empty
  • clean up package.xml
  • Contributors: Paul Bovbel

1.2.2 (2014-10-25)

  • clean up package.xml
  • Fix header reference
  • Fix flow
  • Fix pointer assertion
  • Finalize pointcloud to laserscan
  • Initial pointcloud to laserscan commit
  • Contributors: Paul Bovbel

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 pointcloud_to_laserscan at Robotics Stack Exchange

No version for distro dashing. Known supported distros are highlighted in the buttons above.

pointcloud_to_laserscan package from pointcloud_to_laserscan repo

pointcloud_to_laserscan

Package Summary

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

Repository Summary

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

Converts a 3D Point Cloud into a 2D laser scan. This is useful for making devices like the Kinect appear like a laser scanner for 2D-based algorithms (e.g. laser-based SLAM).

Additional Links

Maintainers

  • Paul Bovbel
  • Michel Hidalgo

Authors

  • Paul Bovbel
  • Michel Hidalgo
  • Tully Foote

ROS 2 pointcloud <-> laserscan converters

This is a ROS 2 package that provides components to convert sensor_msgs/msg/PointCloud2 messages to sensor_msgs/msg/LaserScan messages and back. It is essentially a port of the original ROS 1 package.

pointcloud_to_laserscan::PointCloudToLaserScanNode

This ROS 2 component projects sensor_msgs/msg/PointCloud2 messages into sensor_msgs/msg/LaserScan messages.

Published Topics

  • scan (sensor_msgs/msg/LaserScan) - The output laser scan.

Subscribed Topics

  • cloud_in (sensor_msgs/msg/PointCloud2) - The input point cloud. No input will be processed if there isn't at least one subscriber to the scan topic.

Parameters

  • min_height (double, default: 2.2e-308) - The minimum height to sample in the point cloud in meters.
  • max_height (double, default: 1.8e+308) - The maximum height to sample in the point cloud in meters.
  • angle_min (double, default: -π) - The minimum scan angle in radians.
  • angle_max (double, default: π) - The maximum scan angle in radians.
  • angle_increment (double, default: π/180) - Resolution of laser scan in radians per ray.
  • queue_size (double, default: detected number of cores) - Input point cloud queue size.
  • scan_time (double, default: 1.0/30.0) - The scan rate in seconds. Only used to populate the scan_time field of the output laser scan message.
  • range_min (double, default: 0.0) - The minimum ranges to return in meters.
  • range_max (double, default: 1.8e+308) - The maximum ranges to return in meters.
  • target_frame (str, default: none) - If provided, transform the pointcloud into this frame before converting to a laser scan. Otherwise, laser scan will be generated in the same frame as the input point cloud.
  • transform_tolerance (double, default: 0.01) - Time tolerance for transform lookups. Only used if a target_frame is provided.
  • use_inf (boolean, default: true) - If disabled, report infinite range (no obstacle) as range_max + 1. Otherwise report infinite range as +inf.

pointcloud_to_laserscan::LaserScanToPointCloudNode

This ROS 2 component re-publishes sensor_msgs/msg/LaserScan messages as sensor_msgs/msg/PointCloud2 messages.

Published Topics

  • cloud (sensor_msgs/msg/PointCloud2) - The output point cloud.

Subscribed Topics

  • scan_in (sensor_msgs/msg/LaserScan) - The input laser scan. No input will be processed if there isn't at least one subscriber to the cloud topic.

Parameters

  • queue_size (double, default: detected number of cores) - Input laser scan queue size.
  • target_frame (str, default: none) - If provided, transform the pointcloud into this frame before converting to a laser scan. Otherwise, laser scan will be generated in the same frame as the input point cloud.
  • transform_tolerance (double, default: 0.01) - Time tolerance for transform lookups. Only used if a target_frame is provided.
CHANGELOG

Changelog for package pointcloud_to_laserscan

2.0.1 (2021-10-19)

  • Replace deprecated launch api (#56)
  • Fix linting errors in the code (#52)
  • Update README.md
  • Contributors: Chris Lalancette, Daisuke Nishimatsu, Paul Bovbel

2.0.0 (2020-02-10)

  • ROS 2 Migration (#33) * ROS 2 Migration Signed-off-by: Michel Hidalgo <michel@ekumenlabs.com>

  • Contributors: Michel Hidalgo

1.4.1 (2019-08-30)

  • 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

1.4.0 (2017-11-14)

  • 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

1.3.1 (2017-04-26)

  • 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

1.3.0 (2015-06-09)

  • Fix pointcloud to laserscan transform tolerance issues
  • Move pointcloud_to_laserscan to new repository
  • Contributors: Paul Bovbel

1.2.7 (2015-06-08)

  • Cleanup pointcloud_to_laserscan launch files
  • Contributors: Paul Bovbel

1.2.6 (2015-02-04)

  • Fix default value for concurrency
  • Fix multithreaded lazy pub sub
  • Contributors: Paul Bovbel

1.2.5 (2015-01-20)

  • Switch to tf_sensor_msgs for transform
  • Set parameters in sample launch files to default
  • Add tolerance parameter
  • Contributors: Paul Bovbel

1.2.4 (2015-01-15)

  • 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

1.2.3 (2015-01-10)

  • add launch tests
  • refactor naming and fix nodelet export
  • set default target frame to empty
  • clean up package.xml
  • Contributors: Paul Bovbel

1.2.2 (2014-10-25)

  • clean up package.xml
  • Fix header reference
  • Fix flow
  • Fix pointer assertion
  • Finalize pointcloud to laserscan
  • Initial pointcloud to laserscan commit
  • Contributors: Paul Bovbel

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 pointcloud_to_laserscan at Robotics Stack Exchange

pointcloud_to_laserscan package from pointcloud_to_laserscan repo

pointcloud_to_laserscan

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/pointcloud_to_laserscan.git
VCS Type git
VCS Version foxy
Last Updated 2022-06-27
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

Converts a 3D Point Cloud into a 2D laser scan. This is useful for making devices like the Kinect appear like a laser scanner for 2D-based algorithms (e.g. laser-based SLAM).

Additional Links

Maintainers

  • Paul Bovbel
  • Michel Hidalgo

Authors

  • Paul Bovbel
  • Michel Hidalgo
  • Tully Foote

ROS 2 pointcloud <-> laserscan converters

This is a ROS 2 package that provides components to convert sensor_msgs/msg/PointCloud2 messages to sensor_msgs/msg/LaserScan messages and back. It is essentially a port of the original ROS 1 package.

pointcloud_to_laserscan::PointCloudToLaserScanNode

This ROS 2 component projects sensor_msgs/msg/PointCloud2 messages into sensor_msgs/msg/LaserScan messages.

Published Topics

  • scan (sensor_msgs/msg/LaserScan) - The output laser scan.

Subscribed Topics

  • cloud_in (sensor_msgs/msg/PointCloud2) - The input point cloud. No input will be processed if there isn't at least one subscriber to the scan topic.

Parameters

  • min_height (double, default: 2.2e-308) - The minimum height to sample in the point cloud in meters.
  • max_height (double, default: 1.8e+308) - The maximum height to sample in the point cloud in meters.
  • angle_min (double, default: -π) - The minimum scan angle in radians.
  • angle_max (double, default: π) - The maximum scan angle in radians.
  • angle_increment (double, default: π/180) - Resolution of laser scan in radians per ray.
  • queue_size (double, default: detected number of cores) - Input point cloud queue size.
  • scan_time (double, default: 1.0/30.0) - The scan rate in seconds. Only used to populate the scan_time field of the output laser scan message.
  • range_min (double, default: 0.0) - The minimum ranges to return in meters.
  • range_max (double, default: 1.8e+308) - The maximum ranges to return in meters.
  • target_frame (str, default: none) - If provided, transform the pointcloud into this frame before converting to a laser scan. Otherwise, laser scan will be generated in the same frame as the input point cloud.
  • transform_tolerance (double, default: 0.01) - Time tolerance for transform lookups. Only used if a target_frame is provided.
  • use_inf (boolean, default: true) - If disabled, report infinite range (no obstacle) as range_max + 1. Otherwise report infinite range as +inf.

pointcloud_to_laserscan::LaserScanToPointCloudNode

This ROS 2 component re-publishes sensor_msgs/msg/LaserScan messages as sensor_msgs/msg/PointCloud2 messages.

Published Topics

  • cloud (sensor_msgs/msg/PointCloud2) - The output point cloud.

Subscribed Topics

  • scan_in (sensor_msgs/msg/LaserScan) - The input laser scan. No input will be processed if there isn't at least one subscriber to the cloud topic.

Parameters

  • queue_size (double, default: detected number of cores) - Input laser scan queue size.
  • target_frame (str, default: none) - If provided, transform the pointcloud into this frame before converting to a laser scan. Otherwise, laser scan will be generated in the same frame as the input point cloud.
  • transform_tolerance (double, default: 0.01) - Time tolerance for transform lookups. Only used if a target_frame is provided.
CHANGELOG

Changelog for package pointcloud_to_laserscan

2.0.1 (2021-10-19)

  • Replace deprecated launch api (#56)
  • Fix linting errors in the code (#52)
  • Update README.md
  • Contributors: Chris Lalancette, Daisuke Nishimatsu, Paul Bovbel

2.0.0 (2020-02-10)

  • ROS 2 Migration (#33) * ROS 2 Migration Signed-off-by: Michel Hidalgo <michel@ekumenlabs.com>

  • Contributors: Michel Hidalgo

1.4.1 (2019-08-30)

  • 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

1.4.0 (2017-11-14)

  • 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

1.3.1 (2017-04-26)

  • 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

1.3.0 (2015-06-09)

  • Fix pointcloud to laserscan transform tolerance issues
  • Move pointcloud_to_laserscan to new repository
  • Contributors: Paul Bovbel

1.2.7 (2015-06-08)

  • Cleanup pointcloud_to_laserscan launch files
  • Contributors: Paul Bovbel

1.2.6 (2015-02-04)

  • Fix default value for concurrency
  • Fix multithreaded lazy pub sub
  • Contributors: Paul Bovbel

1.2.5 (2015-01-20)

  • Switch to tf_sensor_msgs for transform
  • Set parameters in sample launch files to default
  • Add tolerance parameter
  • Contributors: Paul Bovbel

1.2.4 (2015-01-15)

  • 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

1.2.3 (2015-01-10)

  • add launch tests
  • refactor naming and fix nodelet export
  • set default target frame to empty
  • clean up package.xml
  • Contributors: Paul Bovbel

1.2.2 (2014-10-25)

  • clean up package.xml
  • Fix header reference
  • Fix flow
  • Fix pointer assertion
  • Finalize pointcloud to laserscan
  • Initial pointcloud to laserscan commit
  • Contributors: Paul Bovbel

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 pointcloud_to_laserscan at Robotics Stack Exchange

pointcloud_to_laserscan package from pointcloud_to_laserscan repo

pointcloud_to_laserscan

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/pointcloud_to_laserscan.git
VCS Type git
VCS Version indigo-devel
Last Updated 2017-04-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

Converts a 3D Point Cloud into a 2D laser scan. This is useful for making devices like the Kinect appear like a laser scanner for 2D-based algorithms (e.g. laser-based SLAM).

Additional Links

Maintainers

  • Paul Bovbel

Authors

  • Paul Bovbel
  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package pointcloud_to_laserscan

1.3.1 (2017-04-26)

  • 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

1.3.0 (2015-06-09)

  • Fix pointcloud to laserscan transform tolerance issues
  • Move pointcloud_to_laserscan to new repository
  • Contributors: Paul Bovbel

1.2.7 (2015-06-08)

  • Cleanup pointcloud_to_laserscan launch files
  • Contributors: Paul Bovbel

1.2.6 (2015-02-04)

  • Fix default value for concurrency
  • Fix multithreaded lazy pub sub
  • Contributors: Paul Bovbel

1.2.5 (2015-01-20)

  • Switch to tf_sensor_msgs for transform
  • Set parameters in sample launch files to default
  • Add tolerance parameter
  • Contributors: Paul Bovbel

1.2.4 (2015-01-15)

  • 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

1.2.3 (2015-01-10)

  • add launch tests
  • refactor naming and fix nodelet export
  • set default target frame to empty
  • clean up package.xml
  • Contributors: Paul Bovbel

1.2.2 (2014-10-25)

  • clean up package.xml
  • Fix header reference
  • Fix flow
  • Fix pointer assertion
  • Finalize pointcloud to laserscan
  • Initial pointcloud to laserscan commit
  • Contributors: Paul Bovbel

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

No known dependants.

Launch files

Messages

No message files found.

Services

No service files found

Plugins

Recent questions tagged pointcloud_to_laserscan at Robotics Stack Exchange

pointcloud_to_laserscan package from pointcloud_to_laserscan repo

pointcloud_to_laserscan

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/pointcloud_to_laserscan.git
VCS Type git
VCS Version indigo-devel
Last Updated 2017-04-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

Converts a 3D Point Cloud into a 2D laser scan. This is useful for making devices like the Kinect appear like a laser scanner for 2D-based algorithms (e.g. laser-based SLAM).

Additional Links

Maintainers

  • Paul Bovbel

Authors

  • Paul Bovbel
  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package pointcloud_to_laserscan

1.3.1 (2017-04-26)

  • 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

1.3.0 (2015-06-09)

  • Fix pointcloud to laserscan transform tolerance issues
  • Move pointcloud_to_laserscan to new repository
  • Contributors: Paul Bovbel

1.2.7 (2015-06-08)

  • Cleanup pointcloud_to_laserscan launch files
  • Contributors: Paul Bovbel

1.2.6 (2015-02-04)

  • Fix default value for concurrency
  • Fix multithreaded lazy pub sub
  • Contributors: Paul Bovbel

1.2.5 (2015-01-20)

  • Switch to tf_sensor_msgs for transform
  • Set parameters in sample launch files to default
  • Add tolerance parameter
  • Contributors: Paul Bovbel

1.2.4 (2015-01-15)

  • 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

1.2.3 (2015-01-10)

  • add launch tests
  • refactor naming and fix nodelet export
  • set default target frame to empty
  • clean up package.xml
  • Contributors: Paul Bovbel

1.2.2 (2014-10-25)

  • clean up package.xml
  • Fix header reference
  • Fix flow
  • Fix pointer assertion
  • Finalize pointcloud to laserscan
  • Initial pointcloud to laserscan commit
  • Contributors: Paul Bovbel

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

No known dependants.

Launch files

Messages

No message files found.

Services

No service files found

Plugins

Recent questions tagged pointcloud_to_laserscan at Robotics Stack Exchange

pointcloud_to_laserscan package from pointcloud_to_laserscan repo

pointcloud_to_laserscan

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/pointcloud_to_laserscan.git
VCS Type git
VCS Version indigo-devel
Last Updated 2017-04-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

Converts a 3D Point Cloud into a 2D laser scan. This is useful for making devices like the Kinect appear like a laser scanner for 2D-based algorithms (e.g. laser-based SLAM).

Additional Links

Maintainers

  • Paul Bovbel

Authors

  • Paul Bovbel
  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package pointcloud_to_laserscan

1.3.1 (2017-04-26)

  • 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

1.3.0 (2015-06-09)

  • Fix pointcloud to laserscan transform tolerance issues
  • Move pointcloud_to_laserscan to new repository
  • Contributors: Paul Bovbel

1.2.7 (2015-06-08)

  • Cleanup pointcloud_to_laserscan launch files
  • Contributors: Paul Bovbel

1.2.6 (2015-02-04)

  • Fix default value for concurrency
  • Fix multithreaded lazy pub sub
  • Contributors: Paul Bovbel

1.2.5 (2015-01-20)

  • Switch to tf_sensor_msgs for transform
  • Set parameters in sample launch files to default
  • Add tolerance parameter
  • Contributors: Paul Bovbel

1.2.4 (2015-01-15)

  • 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

1.2.3 (2015-01-10)

  • add launch tests
  • refactor naming and fix nodelet export
  • set default target frame to empty
  • clean up package.xml
  • Contributors: Paul Bovbel

1.2.2 (2014-10-25)

  • clean up package.xml
  • Fix header reference
  • Fix flow
  • Fix pointer assertion
  • Finalize pointcloud to laserscan
  • Initial pointcloud to laserscan commit
  • Contributors: Paul Bovbel

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

Messages

No message files found.

Services

No service files found

Plugins

Recent questions tagged pointcloud_to_laserscan 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

Converts a 3D Point Cloud into a 2D laser scan. This is useful for making devices like the Kinect appear like a laser scanner for 2D-based algorithms (e.g. laser-based SLAM).

Additional Links

Maintainers

  • Paul Bovbel

Authors

  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package pointcloud_to_laserscan

1.1.11 (2015-01-10)

  • add launch tests
  • refactor naming and fix nodelet export
  • set default target frame to empty
  • Contributors: Paul Bovbel

1.1.10 (2014-10-25)

  • update changelogs
  • clean up package.xml
  • Fix header reference
  • Fix flow
  • Fix pointer assertion
  • Finalize pointcloud to laserscan
  • Initial pointcloud to laserscan commit
  • Contributors: Paul Bovbel

1.1.9 (2014-09-13 21:24)

1.1.8 (2014-04-10)

1.1.7 (2013-09-20 11:37)

1.1.6 (2013-09-20 10:36)

1.1.5 (2013-08-27)

1.1.4 (2013-07-23)

1.1.3 (2013-07-19 21:15)

1.1.2 (2013-07-19 17:28)

1.1.1 (2013-07-10)

1.1.0 (2013-07-09 23:56)

1.0.36 (2013-09-20 10:54)

1.0.35 (2013-07-09 23:32)

1.0.34 (2013-05-21)

1.0.33 (2013-05-20)

1.0.32 (2013-05-17)

1.0.31 (2013-04-22 11:58)

1.0.30 (2013-04-22 11:47)

1.0.29 (2013-03-04)

1.0.28 (2013-02-05 12:29)

1.0.27 (2013-02-05 12:10)

1.0.26 (2013-01-17)

1.0.25 (2013-01-01)

1.0.24 (2012-12-21)

1.0.23 (2012-12-19 16:52)

1.0.22 (2012-12-19 15:22)

1.0.21 (2012-12-18 17:42)

1.0.20 (2012-12-18 14:21)

1.0.19 (2012-12-17 21:47)

1.0.18 (2012-12-17 21:17)

1.0.17 (2012-10-26 09:28)

1.0.16 (2012-10-26 08:53)

1.0.15 (2012-10-24)

1.0.14 (2012-10-23)

1.0.13 (2012-10-11 17:46)

1.0.12 (2012-10-11 17:25)

1.0.11 (2012-10-10)

1.0.10 (2012-10-04)

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

Messages

No message files found.

Services

No service files found

Plugins

Recent questions tagged pointcloud_to_laserscan at Robotics Stack Exchange

pointcloud_to_laserscan package from pointcloud_to_laserscan repo

pointcloud_to_laserscan

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-perception/pointcloud_to_laserscan.git
VCS Type git
VCS Version indigo-devel
Last Updated 2017-04-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

Converts a 3D Point Cloud into a 2D laser scan. This is useful for making devices like the Kinect appear like a laser scanner for 2D-based algorithms (e.g. laser-based SLAM).

Additional Links

Maintainers

  • Paul Bovbel

Authors

  • Paul Bovbel
  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package pointcloud_to_laserscan

1.3.1 (2017-04-26)

  • 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

1.3.0 (2015-06-09)

  • Fix pointcloud to laserscan transform tolerance issues
  • Move pointcloud_to_laserscan to new repository
  • Contributors: Paul Bovbel

1.2.7 (2015-06-08)

  • Cleanup pointcloud_to_laserscan launch files
  • Contributors: Paul Bovbel

1.2.6 (2015-02-04)

  • Fix default value for concurrency
  • Fix multithreaded lazy pub sub
  • Contributors: Paul Bovbel

1.2.5 (2015-01-20)

  • Switch to tf_sensor_msgs for transform
  • Set parameters in sample launch files to default
  • Add tolerance parameter
  • Contributors: Paul Bovbel

1.2.4 (2015-01-15)

  • 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

1.2.3 (2015-01-10)

  • add launch tests
  • refactor naming and fix nodelet export
  • set default target frame to empty
  • clean up package.xml
  • Contributors: Paul Bovbel

1.2.2 (2014-10-25)

  • clean up package.xml
  • Fix header reference
  • Fix flow
  • Fix pointer assertion
  • Finalize pointcloud to laserscan
  • Initial pointcloud to laserscan commit
  • Contributors: Paul Bovbel

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

Messages

No message files found.

Services

No service files found

Plugins

Recent questions tagged pointcloud_to_laserscan at Robotics Stack Exchange

pointcloud_to_laserscan package from pointcloud_to_laserscan repo

pointcloud_to_laserscan

Package Summary

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

Repository Summary

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

Converts a 3D Point Cloud into a 2D laser scan. This is useful for making devices like the Kinect appear like a laser scanner for 2D-based algorithms (e.g. laser-based SLAM).

Additional Links

Maintainers

  • Paul Bovbel
  • Michel Hidalgo

Authors

  • Paul Bovbel
  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package pointcloud_to_laserscan

1.4.1 (2019-08-30)

  • 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

1.4.0 (2017-11-14)

  • 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

1.3.1 (2017-04-26)

  • 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

1.3.0 (2015-06-09)

  • Fix pointcloud to laserscan transform tolerance issues
  • Move pointcloud_to_laserscan to new repository
  • Contributors: Paul Bovbel

1.2.7 (2015-06-08)

  • Cleanup pointcloud_to_laserscan launch files
  • Contributors: Paul Bovbel

1.2.6 (2015-02-04)

  • Fix default value for concurrency
  • Fix multithreaded lazy pub sub
  • Contributors: Paul Bovbel

1.2.5 (2015-01-20)

  • Switch to tf_sensor_msgs for transform
  • Set parameters in sample launch files to default
  • Add tolerance parameter
  • Contributors: Paul Bovbel

1.2.4 (2015-01-15)

  • 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

1.2.3 (2015-01-10)

  • add launch tests
  • refactor naming and fix nodelet export
  • set default target frame to empty
  • clean up package.xml
  • Contributors: Paul Bovbel

1.2.2 (2014-10-25)

  • clean up package.xml
  • Fix header reference
  • Fix flow
  • Fix pointer assertion
  • Finalize pointcloud to laserscan
  • Initial pointcloud to laserscan commit
  • Contributors: Paul Bovbel

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

Messages

No message files found.

Services

No service files found

Plugins

Recent questions tagged pointcloud_to_laserscan at Robotics Stack Exchange