Public Member Functions | Protected Member Functions | Private Attributes
costmap_converter::BaseCostmapToPolygons Class Reference

This abstract class defines the interface for plugins that convert the costmap into polygon types. More...

#include <costmap_converter_interface.h>

Inheritance diagram for costmap_converter::BaseCostmapToPolygons:
Inheritance graph
[legend]

List of all members.

Public Member Functions

virtual void compute ()=0
 This method performs the actual work (conversion of the costmap to polygons)
virtual ObstacleArrayConstPtr getObstacles ()
 Get a shared instance of the current obstacle container If this method is not overwritten by the underlying plugin, the obstacle container just imports getPolygons().
virtual PolygonContainerConstPtr getPolygons ()
 Get a shared instance of the current polygon container.
virtual void initialize (ros::NodeHandle nh)=0
 Initialize the plugin.
virtual void setCostmap2D (costmap_2d::Costmap2D *costmap)=0
 Pass a pointer to the costap to the plugin.
virtual void setOdomTopic (const std::string &odom_topic)
 Set name of robot's odometry topic.
virtual bool stackedCostmapConversion ()
 Determines whether an additional plugin for subsequent costmap conversion is specified.
void startWorker (ros::Rate rate, costmap_2d::Costmap2D *costmap, bool spin_thread=false)
 Instantiate a worker that repeatedly coverts the most recent costmap to polygons. The worker is implemented as a timer event that is invoked at a specific rate. The passed costmap pointer must be valid at the complete time and must be lockable. By specifying the argument spin_thread the timer event is invoked in a separate thread and callback queue or otherwise it is called from the global callback queue (of the node in which the plugin is used).
void stopWorker ()
 Stop the worker that repeatedly converts the costmap to polygons.
virtual void updateCostmap2D ()=0
 Get updated data from the previously set Costmap2D.
virtual ~BaseCostmapToPolygons ()
 Destructor.

Protected Member Functions

 BaseCostmapToPolygons ()
 Protected constructor that should be called by subclasses.
void spinThread ()
 Blocking method that checks for new timer events (active if startWorker() is called with spin_thread enabled)
void workerCallback (const ros::TimerEvent &)
 The callback of the worker that performs the actual work (updating the costmap and converting it to polygons)

Private Attributes

ros::CallbackQueue callback_queue_
bool need_to_terminate_
ros::NodeHandle nh_
boost::thread * spin_thread_
boost::mutex terminate_mutex_
ros::Timer worker_timer_

Detailed Description

This abstract class defines the interface for plugins that convert the costmap into polygon types.

Plugins must accept a costmap_2d::Costmap2D datatype as information source. The interface provides two different use cases: 1. Manual call to conversion routines: setCostmap2D(), compute() and getPolygons() (in subsequent calls setCostmap2D() can be substituted by updateCostmap2D()) 2. Repeatedly process costmap with a specific rate (startWorker() and stopWorker()): Make sure that the costmap is valid while the worker is active (you can specify your own spinner or activate a threaded spinner). Costmaps can be obtained by invoking getPolygons().

Definition at line 77 of file costmap_converter_interface.h.


Constructor & Destructor Documentation

Destructor.

Definition at line 90 of file costmap_converter_interface.h.

Protected constructor that should be called by subclasses.

Definition at line 229 of file costmap_converter_interface.h.


Member Function Documentation

virtual void costmap_converter::BaseCostmapToPolygons::compute ( ) [pure virtual]

Get a shared instance of the current obstacle container If this method is not overwritten by the underlying plugin, the obstacle container just imports getPolygons().

Remarks:
If compute() or startWorker() has not been called before, this method returns an empty instance!
Warning:
The underlying plugin must ensure that this method is thread safe.
Returns:
Shared instance of the current obstacle container
See also:
getPolygons

Reimplemented in costmap_converter::CostmapToDynamicObstacles.

Definition at line 135 of file costmap_converter_interface.h.

Get a shared instance of the current polygon container.

If this method is not implemented by any subclass (plugin) the returned shared pointer is empty.

Remarks:
If compute() or startWorker() has not been called before, this method returns an empty instance!
Warning:
The underlying plugin must ensure that this method is thread safe.
Returns:
Shared instance of the current polygon container

Reimplemented in costmap_converter::CostmapToPolygonsDBSMCCH.

Definition at line 125 of file costmap_converter_interface.h.

Pass a pointer to the costap to the plugin.

Warning:
The plugin should handle the costmap's mutex locking.
See also:
updateCostmap2D
Parameters:
costmapPointer to the costmap2d source

Implemented in costmap_converter::CostmapToPolygonsDBSMCCH, and costmap_converter::CostmapToDynamicObstacles.

virtual void costmap_converter::BaseCostmapToPolygons::setOdomTopic ( const std::string &  odom_topic) [inline, virtual]

Set name of robot's odometry topic.

Some plugins might require odometry information to compensate the robot's ego motion

Parameters:
odom_topictopic name

Reimplemented in costmap_converter::CostmapToDynamicObstacles.

Definition at line 157 of file costmap_converter_interface.h.

Blocking method that checks for new timer events (active if startWorker() is called with spin_thread enabled)

Definition at line 234 of file costmap_converter_interface.h.

Determines whether an additional plugin for subsequent costmap conversion is specified.

Returns:
false, since all plugins for static costmap conversion are independent

Reimplemented in costmap_converter::BaseCostmapToDynamicObstacles.

Definition at line 164 of file costmap_converter_interface.h.

void costmap_converter::BaseCostmapToPolygons::startWorker ( ros::Rate  rate,
costmap_2d::Costmap2D costmap,
bool  spin_thread = false 
) [inline]

Instantiate a worker that repeatedly coverts the most recent costmap to polygons. The worker is implemented as a timer event that is invoked at a specific rate. The passed costmap pointer must be valid at the complete time and must be lockable. By specifying the argument spin_thread the timer event is invoked in a separate thread and callback queue or otherwise it is called from the global callback queue (of the node in which the plugin is used).

Parameters:
rateThe rate that specifies how often the costmap should be updated
costmapPointer to the underlying costmap (must be valid and lockable as long as the worker is active
spin_threadif true,the timer is invoked in a separate thread, otherwise in the default callback queue)

Definition at line 177 of file costmap_converter_interface.h.

Stop the worker that repeatedly converts the costmap to polygons.

Definition at line 210 of file costmap_converter_interface.h.

Get updated data from the previously set Costmap2D.

Warning:
The plugin should handle the costmap's mutex locking.
See also:
setCostmap2D

Implemented in costmap_converter::CostmapToPolygonsDBSMCCH, and costmap_converter::CostmapToDynamicObstacles.

The callback of the worker that performs the actual work (updating the costmap and converting it to polygons)

Definition at line 250 of file costmap_converter_interface.h.


Member Data Documentation

Definition at line 260 of file costmap_converter_interface.h.

Definition at line 262 of file costmap_converter_interface.h.

Definition at line 258 of file costmap_converter_interface.h.

Definition at line 259 of file costmap_converter_interface.h.

Definition at line 261 of file costmap_converter_interface.h.

Definition at line 257 of file costmap_converter_interface.h.


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


costmap_converter
Author(s): Christoph Rösmann , Franz Albers , Otniel Rinaldo
autogenerated on Sat Jun 8 2019 20:53:15