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.

ndt_nodes 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 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

NDT related ROS2 nodes

Additional Links

No additional links.

Maintainers

  • Apex.AI, Inc.

Authors

No additional authors.

NDT Map Provider Node - Usage and Configuration

Usage

1. Necessary Files

You will need a map file in .pcd format containing the 3D point cloud data of the map.

You will also need a separate map information file in .yaml format. This contains the location of the point cloud map origin in geocentric coordinates.

The map information file (YAML file) should have the following format:

# example_map.yaml
---
map_config:
    latitude: 37.380811523812845
    longitude: -121.90840595108715
    elevation: 16.0
    roll: 0.0
    pitch: 0.0
    yaw: 0.0

where latitude, longitude and elevation are the WGS84 coordinates of the origin of the point cloud map, and roll, pitch and yaw describe the orientation of the map reference frame.

2. Create/edit a parameter file to reference the map YAML file

An example parameter file for the map_publisher node can be found in the following location (inside the ade environment):

/opt/AutowareAuto/share/ndt_nodes/share/param/map_publisher.param.yaml

Alternatively if building from source code the example parameter file will be located here:

~/AutowareAuto/install/ndt_nodes/share/ndt_nodes/param/map_publisher.param.yaml

Copy the file to another location and edit (and uncomment) the map_pcd_file and the map_yaml_file parameters of the file map_publisher.param.yaml to refer to the point cloud map and the YAML map information files:

   map_pcd_file: "/path/to/map_data.pcd"
   map_yaml_file: "/path/to/map_info.yaml"

Be carefull to enter appropriate values for map parameters such as minimum and maximum points.

3. Run the map_publisher node

Inside the ade, source the workspace. If you are using precompiled version source from /opt/AutowareAuto/setup.bash. if you are developing and have built from source code, source the from ~/AutowareAuto/install/setup.bash

Run the node with the paramter file as an argument:

ros2 run ndt_nodes ndt_map_publisher_exe --ros-args --params-file path/to/map_publisher.param.yaml

Alternatively use a launch file: ros2 launch ndt_nodes map_provider.launch.py

which launches the map provider node with the default parameter values in map_publisher.param.yaml, and also launches a voxel_grid_node to sub-sample the point cloud for visualization.

4. Output

By default (as defined in the parameter file), the map_provider node will publish the following information

  • the ndt map on the topic ndt_map
  • the point cloud map visualization on the topic viz_ndt_map
  • if a voxel_grid_node is used to sub-sample the point cloud as in the launch file, it will be published on the topic viz_map_subsampled

Configuration of map provider node

The configurable parameters passed by the parameter file map_publisher.param.yaml of the node are:

Parameter Name Usage
map_pcd_file file name of point cloud data file
map_yaml_file file name of map information file
map_frame frame for map point coordinates
map_config.capacity max ndt map voxel capacity
map_config.min_point.x min x bound for ndt map data
map_config.min_point.y min y bound for ndt map data
map_config.min_point.z min z bound for ndt map data
map_config.max_point.x max x bound for ndt map data
map_config.max_point.y max y bound for ndt map data
map_config.max_point.z max z bound for ndt map data
map_config.voxel_size.x voxel x size for ndt map data
map_config.voxel_size.y voxel y size for ndt map data
map_config.voxel_size.z voxel z size for ndt map data
viz_map flag for whether to publish map for visualization

A voxel_grid_node is used to down sample the point cloud for visualization. An example parameter file for the voxel grid is given at

/opt/AutowareAuto/share/ndt_nodes/share/param/pcl_map_voxel_grid_downsample.param.yaml:

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

No version for distro noetic. Known supported distros are highlighted in the buttons above.
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.
No version for distro lunar. Known supported distros are highlighted in the buttons above.
No version for distro jade. Known supported distros are highlighted in the buttons above.
No version for distro indigo. Known supported distros are highlighted in the buttons above.
No version for distro hydro. Known supported distros are highlighted in the buttons above.
No version for distro kinetic. Known supported distros are highlighted in the buttons above.
No version for distro melodic. Known supported distros are highlighted in the buttons above.