Go to the documentation of this file.
20 #ifndef VOXEL_GRID_NODES__VOXEL_CLOUD_NODE_HPP_
21 #define VOXEL_GRID_NODES__VOXEL_CLOUD_NODE_HPP_
24 #include <rclcpp/rclcpp.hpp>
38 namespace voxel_grid_nodes
41 const std::string & durability);
50 const rclcpp::NodeOptions & node_options);
53 void callback(
const sensor_msgs::msg::PointCloud2::SharedPtr msg);
63 const rclcpp::Subscription<Message>::SharedPtr m_sub_ptr;
64 const std::shared_ptr<rclcpp::Publisher<Message>> m_pub_ptr;
65 std::unique_ptr<algorithm::VoxelCloudBase> m_voxelgrid_ptr;
73 #endif // VOXEL_GRID_NODES__VOXEL_CLOUD_NODE_HPP_
This file includes common type definition.
Boilerplate node that subscribes to point clouds and publishes a downsampled version.
Definition: voxel_cloud_node.hpp:44
bool bool8_t
Definition: types.hpp:39
This file defines the lanelet2_map_provider_node class.
Definition: quick_sort.hpp:24
This file defines the algorithmic interface for applying voxel grid downsampling to a PointCloud2 mes...
A configuration class for the VoxelGrid data structure, also includes some helper functionality for c...
Definition: perception/filters/voxel_grid/include/voxel_grid/config.hpp:52
sensor_msgs::msg::PointCloud2 PointCloud2
Definition: filter_node_base.cpp:32
rmw_qos_durability_policy_t parse_durability_parameter(const std::string &durability)
Definition: voxel_cloud_node.cpp:121