moveit2
The MoveIt Motion Planning Framework for ROS 2.
Loading...
Searching...
No Matches
Public Member Functions | Protected Member Functions | List of all members
occupancy_map_monitor::PointCloudOctomapUpdater Class Reference

#include <pointcloud_octomap_updater.h>

Inheritance diagram for occupancy_map_monitor::PointCloudOctomapUpdater:
Inheritance graph
[legend]
Collaboration diagram for occupancy_map_monitor::PointCloudOctomapUpdater:
Collaboration graph
[legend]

Public Member Functions

 PointCloudOctomapUpdater ()
 
 ~PointCloudOctomapUpdater () override
 
bool setParams (const std::string &name_space) override
 Set updater params using struct that comes from parsing a yaml string. This must be called after setMonitor()
 
bool initialize (const rclcpp::Node::SharedPtr &node) override
 Do any necessary setup (subscribe to ros topics, etc.). This call assumes setMonitor() and setParams() have been previously called.
 
void start () override
 
void stop () override
 
ShapeHandle excludeShape (const shapes::ShapeConstPtr &shape) override
 
void forgetShape (ShapeHandle handle) override
 
- Public Member Functions inherited from occupancy_map_monitor::OccupancyMapUpdater
 OccupancyMapUpdater (const std::string &type)
 
virtual ~OccupancyMapUpdater ()
 
void setMonitor (OccupancyMapMonitor *monitor)
 This is the first function to be called after construction.
 
const std::string & getType () const
 
void setTransformCacheCallback (const TransformCacheProvider &transform_callback)
 
void publishDebugInformation (bool flag)
 

Protected Member Functions

virtual void updateMask (const sensor_msgs::msg::PointCloud2 &cloud, const Eigen::Vector3d &sensor_origin, std::vector< int > &mask)
 
- Protected Member Functions inherited from occupancy_map_monitor::OccupancyMapUpdater
bool updateTransformCache (const std::string &target_frame, const rclcpp::Time &target_time)
 

Additional Inherited Members

- Protected Attributes inherited from occupancy_map_monitor::OccupancyMapUpdater
OccupancyMapMonitormonitor_
 
std::string type_
 
collision_detection::OccMapTreePtr tree_
 
TransformCacheProvider transform_provider_callback_
 
ShapeTransformCache transform_cache_
 
bool debug_info_
 

Detailed Description

Definition at line 56 of file pointcloud_octomap_updater.h.

Constructor & Destructor Documentation

◆ PointCloudOctomapUpdater()

occupancy_map_monitor::PointCloudOctomapUpdater::PointCloudOctomapUpdater ( )

Definition at line 53 of file pointcloud_octomap_updater.cpp.

◆ ~PointCloudOctomapUpdater()

occupancy_map_monitor::PointCloudOctomapUpdater::~PointCloudOctomapUpdater ( )
inlineoverride

Definition at line 60 of file pointcloud_octomap_updater.h.

Member Function Documentation

◆ excludeShape()

ShapeHandle occupancy_map_monitor::PointCloudOctomapUpdater::excludeShape ( const shapes::ShapeConstPtr &  shape)
overridevirtual

◆ forgetShape()

void occupancy_map_monitor::PointCloudOctomapUpdater::forgetShape ( ShapeHandle  handle)
overridevirtual

◆ initialize()

bool occupancy_map_monitor::PointCloudOctomapUpdater::initialize ( const rclcpp::Node::SharedPtr &  node)
overridevirtual

Do any necessary setup (subscribe to ros topics, etc.). This call assumes setMonitor() and setParams() have been previously called.

Implements occupancy_map_monitor::OccupancyMapUpdater.

Definition at line 79 of file pointcloud_octomap_updater.cpp.

◆ setParams()

bool occupancy_map_monitor::PointCloudOctomapUpdater::setParams ( const std::string &  name_space)
overridevirtual

Set updater params using struct that comes from parsing a yaml string. This must be called after setMonitor()

Implements occupancy_map_monitor::OccupancyMapUpdater.

Definition at line 66 of file pointcloud_octomap_updater.cpp.

◆ start()

void occupancy_map_monitor::PointCloudOctomapUpdater::start ( )
overridevirtual

Implements occupancy_map_monitor::OccupancyMapUpdater.

Definition at line 94 of file pointcloud_octomap_updater.cpp.

Here is the call graph for this function:

◆ stop()

void occupancy_map_monitor::PointCloudOctomapUpdater::stop ( )
overridevirtual

◆ updateMask()

void occupancy_map_monitor::PointCloudOctomapUpdater::updateMask ( const sensor_msgs::msg::PointCloud2 &  cloud,
const Eigen::Vector3d &  sensor_origin,
std::vector< int > &  mask 
)
protectedvirtual

Definition at line 170 of file pointcloud_octomap_updater.cpp.


The documentation for this class was generated from the following files: