No version for distro humble. Known supported distros are highlighted in the buttons above.
No version for distro jazzy. Known supported distros are highlighted in the buttons above.
No version for distro rolling. Known supported distros are highlighted in the buttons above.

voxel_grid package from autowareauto repo

autoware_auto_algorithm autoware_auto_common autoware_auto_geometry autoware_auto_tf2 covariance_insertion covariance_insertion_nodes had_map_utils lidar_utils measurement_conversion motion_model mpark_variant_vendor neural_networks optimization osqp_interface reference_tracking_controller signal_filters state_estimation state_estimation_nodes state_vector time_utils tvm_utility vehicle_constants_manager controller_common controller_common_nodes controller_testing motion_common motion_model_testing_simulator motion_testing motion_testing_nodes mpc_controller mpc_controller_nodes pure_pursuit pure_pursuit_nodes trajectory_follower trajectory_follower_nodes lgsvl_interface ne_raptor_interface spinnaker_camera_driver spinnaker_camera_nodes ssc_interface vehicle_interface velodyne_driver velodyne_nodes xsens_driver xsens_nodes hungarian_assigner autoware_auto_launch autoware_demos scenario_simulator_launch localization_common localization_nodes ndt ndt_nodes lanelet2_map_provider ndt_mapping_nodes point_cloud_mapping filter_node_base off_map_obstacles_filter off_map_obstacles_filter_nodes outlier_filter outlier_filter_nodes point_cloud_filter_transform_nodes point_cloud_fusion point_cloud_fusion_nodes polygon_remover polygon_remover_nodes ray_ground_classifier ray_ground_classifier_nodes voxel_grid voxel_grid_nodes apollo_lidar_segmentation apollo_lidar_segmentation_nodes euclidean_cluster euclidean_cluster_nodes ground_truth_detections tracking tracking_nodes tracking_test_framework behavior_planner behavior_planner_nodes lane_planner lane_planner_nodes lanelet2_global_planner lanelet2_global_planner_nodes object_collision_estimator object_collision_estimator_nodes parking_planner parking_planner_nodes recordreplay_planner recordreplay_planner_nodes trajectory_planner_node_base trajectory_smoother trajectory_spoofer lonely_world_prediction prediction_nodes autoware_state_monitor emergency_handler autoware_auto_cmake autoware_auto_create_pkg autoware_auto_examples autoware_testing avp_web_interface benchmark_tool benchmark_tool_nodes cluster_projection_node detection_2d_visualizer fake_test_node gnss_conversion_nodes joystick_vehicle_interface joystick_vehicle_interface_nodes lidar_integration point_type_adapter simple_planning_simulator localization_system_tests test_trajectory_following autoware_rviz_plugins lexus_rx_450h_description

Package Summary

Tags No category tags.
Version 1.0.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/autocore-ai/autowareauto.git
VCS Type git
VCS Version master
Last Updated 2021-11-02
Dev Status UNMAINTAINED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

voxel grid filters

Additional Links

No additional links.

Maintainers

  • Apex.AI, Inc.

Authors

No additional authors.
README
No README found. See repository README.
CHANGELOG
No CHANGELOG found.

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged voxel_grid at Robotics Stack Exchange

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-planning/navigation.git
VCS Type git
VCS Version noetic-devel
Last Updated 2023-03-04
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

voxel_grid provides an implementation of an efficient 3D voxel grid. The occupancy grid can support 3 different representations for the state of a cell: marked, free, or unknown. Due to the underlying implementation relying on bitwise and and or integer operations, the voxel grid only supports 16 different levels per voxel column. However, this limitation yields raytracing and cell marking performance in the grid comparable to standard 2D structures making it quite fast compared to most 3D structures.

Additional Links

Maintainers

  • David V. Lu!!
  • Michael Ferguson
  • Aaron Hoy

Authors

  • Eitan Marder-Eppstein, Eric Berger
  • contradict gmail.com
README
No README found. See repository README.
CHANGELOG

Changelog for package voxel_grid

1.17.3 (2023-01-10)

1.17.2 (2022-06-20)

1.17.1 (2020-08-27)

1.17.0 (2020-04-02)

  • Merge pull request #982 from ros-planning/noetic_prep Noetic Migration
  • increase required cmake version
  • Contributors: Michael Ferguson

1.16.6 (2020-03-18)

1.16.5 (2020-03-15)

  • Fix Uknown CMake command check_include_file (#974)
  • [melodic] updated install for better portability. (#973)
  • Contributors: Sam Pfeiffer, Sean Yen

1.16.4 (2020-03-04)

  • [Windows][melodic] Navigation (except for map_server and amcl) Windows build bring up (#851)
  • Contributors: Sean Yen

1.16.3 (2019-11-15)

1.16.2 (2018-07-31)

1.16.1 (2018-07-28)

1.16.0 (2018-07-25)

1.15.2 (2018-03-22)

  • Merge pull request #673 from ros-planning/email_update_lunar update maintainer email (lunar)
  • Merge pull request #649 from aaronhoy/lunar_add_ahoy Add myself as a maintainer.
  • Contributors: Aaron Hoy, Michael Ferguson

1.15.1 (2017-08-14)

1.15.0 (2017-08-07)

  • convert packages to format2
  • Fix CMakeLists + package.xmls (#548)
  • Contributors: Martin Günther, Mikael Arguedas

1.14.0 (2016-05-20)

1.13.1 (2015-10-29)

1.13.0 (2015-03-17)

1.12.0 (2015-02-04)

  • update maintainer email
  • Contributors: Michael Ferguson

1.11.15 (2015-02-03)

  • Add ARCHIVE_DESTINATION for static builds
  • Contributors: Gary Servin

1.11.14 (2014-12-05)

  • remove old test code
  • fixup voxel_grid.h formatting (whitespace changes ONLY)
  • Contributors: Michael Ferguson

1.11.13 (2014-10-02)

1.11.12 (2014-10-01)

1.11.11 (2014-07-23)

1.11.10 (2014-06-25)

1.11.9 (2014-06-10)

1.11.8 (2014-05-21)

1.11.7 (2014-05-21)

  • uses %u instead of %d for unsigned int
  • Contributors: enriquefernandez

1.11.5 (2014-01-30)

  • Misc. other commits from Groovy Branch
  • check for CATKIN_ENABLE_TESTING
  • Change maintainer from Hersh to Lu

1.11.4 (2013-09-27)

  • Package URL Updates

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged voxel_grid 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.
No version for distro eloquent. Known supported distros are highlighted in the buttons above.
No version for distro dashing. Known supported distros are highlighted in the buttons above.
No version for distro galactic. Known supported distros are highlighted in the buttons above.
No version for distro foxy. Known supported distros are highlighted in the buttons above.
No version for distro iron. Known supported distros are highlighted in the buttons above.

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-planning/navigation.git
VCS Type git
VCS Version lunar
Last Updated 2019-02-28
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

voxel_grid provides an implementation of an efficient 3D voxel grid. The occupancy grid can support 3 different representations for the state of a cell: marked, free, or unknown. Due to the underlying implementation relying on bitwise and and or integer operations, the voxel grid only supports 16 different levels per voxel column. However, this limitation yields raytracing and cell marking performance in the grid comparable to standard 2D structures making it quite fast compared to most 3D structures.

Additional Links

Maintainers

  • David V. Lu!!
  • Michael Ferguson
  • Aaron Hoy

Authors

  • Eitan Marder-Eppstein, Eric Berger
  • contradict gmail.com
README
No README found. See repository README.
CHANGELOG

Changelog for package voxel_grid

1.15.2 (2018-03-22)

  • Merge pull request #673 from ros-planning/email_update_lunar update maintainer email (lunar)
  • Merge pull request #649 from aaronhoy/lunar_add_ahoy Add myself as a maintainer.
  • Contributors: Aaron Hoy, Michael Ferguson

1.15.1 (2017-08-14)

1.15.0 (2017-08-07)

  • convert packages to format2
  • Fix CMakeLists + package.xmls (#548)
  • Contributors: Martin Günther, Mikael Arguedas

1.14.0 (2016-05-20)

1.13.1 (2015-10-29)

1.13.0 (2015-03-17)

1.12.0 (2015-02-04)

  • update maintainer email
  • Contributors: Michael Ferguson

1.11.15 (2015-02-03)

  • Add ARCHIVE_DESTINATION for static builds
  • Contributors: Gary Servin

1.11.14 (2014-12-05)

  • remove old test code
  • fixup voxel_grid.h formatting (whitespace changes ONLY)
  • Contributors: Michael Ferguson

1.11.13 (2014-10-02)

1.11.12 (2014-10-01)

1.11.11 (2014-07-23)

1.11.10 (2014-06-25)

1.11.9 (2014-06-10)

1.11.8 (2014-05-21)

1.11.7 (2014-05-21)

  • uses %u instead of %d for unsigned int
  • Contributors: enriquefernandez

1.11.5 (2014-01-30)

  • Misc. other commits from Groovy Branch
  • check for CATKIN_ENABLE_TESTING
  • Change maintainer from Hersh to Lu

1.11.4 (2013-09-27)

  • Package URL Updates

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged voxel_grid at Robotics Stack Exchange

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-planning/navigation.git
VCS Type git
VCS Version jade-devel
Last Updated 2017-08-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

voxel_grid provides an implementation of an efficient 3D voxel grid. The occupancy grid can support 3 different representations for the state of a cell: marked, free, or unknown. Due to the underlying implementation relying on bitwise and and or integer operations, the voxel grid only supports 16 different levels per voxel column. However, this limitation yields raytracing and cell marking performance in the grid comparable to standard 2D structures making it quite fast compared to most 3D structures.

Additional Links

Maintainers

  • David V. Lu!!
  • Michael Ferguson

Authors

  • Eitan Marder-Eppstein, Eric Berger
  • contradict gmail.com
README
No README found. See repository README.
CHANGELOG

Changelog for package voxel_grid

1.13.1 (2015-10-29)

1.13.0 (2015-03-17)

1.12.0 (2015-02-04)

  • update maintainer email
  • Contributors: Michael Ferguson

1.11.15 (2015-02-03)

  • Add ARCHIVE_DESTINATION for static builds
  • Contributors: Gary Servin

1.11.14 (2014-12-05)

  • remove old test code
  • fixup voxel_grid.h formatting (whitespace changes ONLY)
  • Contributors: Michael Ferguson

1.11.13 (2014-10-02)

1.11.12 (2014-10-01)

1.11.11 (2014-07-23)

1.11.10 (2014-06-25)

1.11.9 (2014-06-10)

1.11.8 (2014-05-21)

1.11.7 (2014-05-21)

  • uses %u instead of %d for unsigned int
  • Contributors: enriquefernandez

1.11.5 (2014-01-30)

  • Misc. other commits from Groovy Branch
  • check for CATKIN_ENABLE_TESTING
  • Change maintainer from Hersh to Lu

1.11.4 (2013-09-27)

  • Package URL Updates

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged voxel_grid at Robotics Stack Exchange

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-planning/navigation.git
VCS Type git
VCS Version indigo-devel
Last Updated 2019-02-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

voxel_grid provides an implementation of an efficient 3D voxel grid. The occupancy grid can support 3 different representations for the state of a cell: marked, free, or unknown. Due to the underlying implementation relying on bitwise and and or integer operations, the voxel grid only supports 16 different levels per voxel column. However, this limitation yields raytracing and cell marking performance in the grid comparable to standard 2D structures making it quite fast compared to most 3D structures.

Additional Links

Maintainers

  • David V. Lu!!
  • Michael Ferguson
  • Aaron Hoy

Authors

  • Eitan Marder-Eppstein, Eric Berger
  • contradict gmail.com
README
No README found. See repository README.
CHANGELOG

Changelog for package voxel_grid

1.12.16 (2018-06-19)

1.12.15 (2018-03-20)

  • Merge pull request #671 from ros-planning/email_update_indigo update maintainer email (indigo)
  • Merge pull request #647 from aaronhoy/indigo_add_ahoy Add myself as a maintainer.
  • Contributors: Aaron Hoy, Michael Ferguson

1.12.14 (2017-12-19)

  • Fix CMakeLists + package.xmls (#548)
  • Contributors: Martin Günther

1.12.13 (2016-08-15)

1.12.12 (2016-06-24)

1.12.11 (2016-06-08)

1.12.10 (2016-05-27)

1.12.9 (2016-05-26)

1.12.8 (2016-05-16)

1.12.7 (2016-01-05)

1.12.6 (2016-01-02)

1.12.5 (2015-10-29)

1.12.4 (2015-06-03)

1.12.3 (2015-04-30)

1.12.2 (2015-03-31)

1.12.1 (2015-03-14)

1.12.0 (2015-02-04)

  • update maintainer email
  • Contributors: Michael Ferguson

1.11.15 (2015-02-03)

  • Add ARCHIVE_DESTINATION for static builds
  • Contributors: Gary Servin

1.11.14 (2014-12-05)

  • remove old test code
  • fixup voxel_grid.h formatting (whitespace changes ONLY)
  • Contributors: Michael Ferguson

1.11.13 (2014-10-02)

1.11.12 (2014-10-01)

1.11.11 (2014-07-23)

1.11.10 (2014-06-25)

1.11.9 (2014-06-10)

1.11.8 (2014-05-21)

1.11.7 (2014-05-21)

  • uses %u instead of %d for unsigned int
  • Contributors: enriquefernandez

1.11.5 (2014-01-30)

  • Misc. other commits from Groovy Branch
  • check for CATKIN_ENABLE_TESTING
  • Change maintainer from Hersh to Lu

1.11.4 (2013-09-27)

  • Package URL Updates

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged voxel_grid at Robotics Stack Exchange

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-planning/navigation.git
VCS Type git
VCS Version hydro-devel
Last Updated 2015-05-01
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

voxel_grid provides an implementation of an efficient 3D voxel grid. The occupancy grid can support 3 different representations for the state of a cell: marked, free, or unknown. Due to the underlying implementation relying on bitwise and and or integer operations, the voxel grid only supports 16 different levels per voxel column. However, this limitation yields raytracing and cell marking performance in the grid comparable to standard 2D structures making it quite fast compared to most 3D structures.

Additional Links

Maintainers

  • David V. Lu!!
  • Michael Ferguson

Authors

  • Eitan Marder-Eppstein, Eric Berger
  • contradict gmail.com
README
No README found. See repository README.
CHANGELOG

Changelog for package voxel_grid

1.11.16 (2015-04-30)

  • update maintainer email
  • Contributors: Michael Ferguson

1.11.15 (2015-02-03)

  • Add ARCHIVE_DESTINATION for static builds
  • Contributors: Gary Servin

1.11.14 (2014-12-05)

  • remove old test code
  • fixup voxel_grid.h formatting (whitespace changes ONLY)
  • Contributors: Michael Ferguson

1.11.13 (2014-10-02)

1.11.12 (2014-10-01)

1.11.11 (2014-07-23)

1.11.10 (2014-06-25)

1.11.9 (2014-06-10)

1.11.8 (2014-05-21)

1.11.7 (2014-05-21)

  • uses %u instead of %d for unsigned int
  • Contributors: enriquefernandez

1.11.5 (2014-01-30)

  • Misc. other commits from Groovy Branch
  • check for CATKIN_ENABLE_TESTING
  • Change maintainer from Hersh to Lu

1.11.4 (2013-09-27)

  • Package URL Updates

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged voxel_grid at Robotics Stack Exchange

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-planning/navigation.git
VCS Type git
VCS Version kinetic-devel
Last Updated 2021-01-19
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

voxel_grid provides an implementation of an efficient 3D voxel grid. The occupancy grid can support 3 different representations for the state of a cell: marked, free, or unknown. Due to the underlying implementation relying on bitwise and and or integer operations, the voxel grid only supports 16 different levels per voxel column. However, this limitation yields raytracing and cell marking performance in the grid comparable to standard 2D structures making it quite fast compared to most 3D structures.

Additional Links

Maintainers

  • David V. Lu!!
  • Michael Ferguson
  • Aaron Hoy

Authors

  • Eitan Marder-Eppstein, Eric Berger
  • contradict gmail.com
README
No README found. See repository README.
CHANGELOG

Changelog for package voxel_grid

1.14.9 (2021-01-05)

1.14.8 (2020-08-27)

1.14.7 (2020-03-10)

1.14.6 (2020-03-04)

1.14.5 (2019-11-15)

1.14.4 (2018-06-19)

1.14.3 (2018-03-16)

  • Merge pull request #672 from ros-planning/email_update_kinetic update maintainer email (kinetic)
  • Merge pull request #648 from aaronhoy/kinetic_add_ahoy Add myself as a maintainer.
  • Contributors: Aaron Hoy, Michael Ferguson

1.14.2 (2017-08-14)

1.14.1 (2017-08-07)

  • Fix CMakeLists + package.xmls (#548)
  • Contributors: Martin Günther

1.14.0 (2016-05-20)

1.13.1 (2015-10-29)

1.13.0 (2015-03-17)

1.12.0 (2015-02-04)

  • update maintainer email
  • Contributors: Michael Ferguson

1.11.15 (2015-02-03)

  • Add ARCHIVE_DESTINATION for static builds
  • Contributors: Gary Servin

1.11.14 (2014-12-05)

  • remove old test code
  • fixup voxel_grid.h formatting (whitespace changes ONLY)
  • Contributors: Michael Ferguson

1.11.13 (2014-10-02)

1.11.12 (2014-10-01)

1.11.11 (2014-07-23)

1.11.10 (2014-06-25)

1.11.9 (2014-06-10)

1.11.8 (2014-05-21)

1.11.7 (2014-05-21)

  • uses %u instead of %d for unsigned int
  • Contributors: enriquefernandez

1.11.5 (2014-01-30)

  • Misc. other commits from Groovy Branch
  • check for CATKIN_ENABLE_TESTING
  • Change maintainer from Hersh to Lu

1.11.4 (2013-09-27)

  • Package URL Updates

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged voxel_grid at Robotics Stack Exchange

Package Summary

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

Repository Summary

Checkout URI https://github.com/ros-planning/navigation.git
VCS Type git
VCS Version melodic-devel
Last Updated 2022-06-20
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

voxel_grid provides an implementation of an efficient 3D voxel grid. The occupancy grid can support 3 different representations for the state of a cell: marked, free, or unknown. Due to the underlying implementation relying on bitwise and and or integer operations, the voxel grid only supports 16 different levels per voxel column. However, this limitation yields raytracing and cell marking performance in the grid comparable to standard 2D structures making it quite fast compared to most 3D structures.

Additional Links

Maintainers

  • David V. Lu!!
  • Michael Ferguson
  • Aaron Hoy

Authors

  • Eitan Marder-Eppstein, Eric Berger
  • contradict gmail.com
README
No README found. See repository README.
CHANGELOG

Changelog for package voxel_grid

1.16.7 (2020-08-27)

1.16.6 (2020-03-18)

1.16.5 (2020-03-15)

  • Fix Uknown CMake command check_include_file (#974)
  • [melodic] updated install for better portability. (#973)
  • Contributors: Sam Pfeiffer, Sean Yen

1.16.4 (2020-03-04)

  • [Windows][melodic] Navigation (except for map_server and amcl) Windows build bring up (#851)
  • Contributors: Sean Yen

1.16.3 (2019-11-15)

1.16.2 (2018-07-31)

1.16.1 (2018-07-28)

1.16.0 (2018-07-25)

1.15.2 (2018-03-22)

  • Merge pull request #673 from ros-planning/email_update_lunar update maintainer email (lunar)
  • Merge pull request #649 from aaronhoy/lunar_add_ahoy Add myself as a maintainer.
  • Contributors: Aaron Hoy, Michael Ferguson

1.15.1 (2017-08-14)

1.15.0 (2017-08-07)

  • convert packages to format2
  • Fix CMakeLists + package.xmls (#548)
  • Contributors: Martin Günther, Mikael Arguedas

1.14.0 (2016-05-20)

1.13.1 (2015-10-29)

1.13.0 (2015-03-17)

1.12.0 (2015-02-04)

  • update maintainer email
  • Contributors: Michael Ferguson

1.11.15 (2015-02-03)

  • Add ARCHIVE_DESTINATION for static builds
  • Contributors: Gary Servin

1.11.14 (2014-12-05)

  • remove old test code
  • fixup voxel_grid.h formatting (whitespace changes ONLY)
  • Contributors: Michael Ferguson

1.11.13 (2014-10-02)

1.11.12 (2014-10-01)

1.11.11 (2014-07-23)

1.11.10 (2014-06-25)

1.11.9 (2014-06-10)

1.11.8 (2014-05-21)

1.11.7 (2014-05-21)

  • uses %u instead of %d for unsigned int
  • Contributors: enriquefernandez

1.11.5 (2014-01-30)

  • Misc. other commits from Groovy Branch
  • check for CATKIN_ENABLE_TESTING
  • Change maintainer from Hersh to Lu

1.11.4 (2013-09-27)

  • Package URL Updates

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged voxel_grid at Robotics Stack Exchange