$search

cart_local_planner::SBPLSubscriber< SBPLPlan > Class Template Reference

#include <sbpl_subscriber.h>

List of all members.

Public Types

typedef std::vector
< geometry_msgs::PoseStamped
MBPlan

Public Member Functions

boost::optional< SBPLPlan > lookupPlan (const MBPlan &mb_plan) const
 SBPLSubscriber (const ros::NodeHandle &nh, const std::string &topic, const double timeout=0.01, const unsigned buffer_size=10)

Private Member Functions

void planCB (const SBPLPlan &sbpl_plan)

Private Attributes

boost::mutex mutex_
ros::NodeHandle nh_
boost::circular_buffer< SBPLPlan > plan_buffer_
ros::Subscriber sub_
const double timeout_

Detailed Description

template<class SBPLPlan>
class cart_local_planner::SBPLSubscriber< SBPLPlan >

Definition at line 53 of file sbpl_subscriber.h.


Member Typedef Documentation

template<class SBPLPlan >
typedef std::vector<geometry_msgs::PoseStamped> cart_local_planner::SBPLSubscriber< SBPLPlan >::MBPlan

Definition at line 56 of file sbpl_subscriber.h.


Constructor & Destructor Documentation

template<class SBPLPlan >
cart_local_planner::SBPLSubscriber< SBPLPlan >::SBPLSubscriber ( const ros::NodeHandle nh,
const std::string &  topic,
const double  timeout = 0.01,
const unsigned  buffer_size = 10 
) [inline]

Definition at line 58 of file sbpl_subscriber.h.


Member Function Documentation

template<class SBPLPlan >
boost::optional<SBPLPlan> cart_local_planner::SBPLSubscriber< SBPLPlan >::lookupPlan ( const MBPlan mb_plan  )  const [inline]

Definition at line 65 of file sbpl_subscriber.h.

template<class SBPLPlan >
void cart_local_planner::SBPLSubscriber< SBPLPlan >::planCB ( const SBPLPlan &  sbpl_plan  )  [inline, private]

Definition at line 92 of file sbpl_subscriber.h.


Member Data Documentation

template<class SBPLPlan >
boost::mutex cart_local_planner::SBPLSubscriber< SBPLPlan >::mutex_ [mutable, private]

Definition at line 86 of file sbpl_subscriber.h.

template<class SBPLPlan >
ros::NodeHandle cart_local_planner::SBPLSubscriber< SBPLPlan >::nh_ [private]

Definition at line 87 of file sbpl_subscriber.h.

template<class SBPLPlan >
boost::circular_buffer<SBPLPlan> cart_local_planner::SBPLSubscriber< SBPLPlan >::plan_buffer_ [private]

Definition at line 89 of file sbpl_subscriber.h.

template<class SBPLPlan >
ros::Subscriber cart_local_planner::SBPLSubscriber< SBPLPlan >::sub_ [private]

Definition at line 88 of file sbpl_subscriber.h.

template<class SBPLPlan >
const double cart_local_planner::SBPLSubscriber< SBPLPlan >::timeout_ [private]

Definition at line 90 of file sbpl_subscriber.h.


The documentation for this class was generated from the following file:
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Properties Friends


cart_local_planner
Author(s): Jonathan Scholz
autogenerated on Fri Mar 1 15:05:27 2013