|
typedef boost::shared_ptr< const std::vector< int > > | IndicesConstPtr |
|
typedef boost::shared_ptr< std::vector< int > > | IndicesPtr |
|
typedef pcl_msgs::ModelCoefficients | ModelCoefficients |
|
typedef ModelCoefficients::ConstPtr | ModelCoefficientsConstPtr |
|
typedef ModelCoefficients::Ptr | ModelCoefficientsPtr |
|
typedef pcl::PointCloud< pcl::PointXYZ > | PointCloud |
|
typedef sensor_msgs::PointCloud2 | PointCloud2 |
|
typedef PointCloud::ConstPtr | PointCloudConstPtr |
|
typedef PointCloud::Ptr | PointCloudPtr |
|
typedef pcl_msgs::PointIndices | PointIndices |
|
typedef PointIndices::ConstPtr | PointIndicesConstPtr |
|
typedef PointIndices::Ptr | PointIndicesPtr |
|
| PCLNodelet () |
|
| NodeletLazy () |
|
void | init (const std::string &name, const M_string &remapping_args, const V_string &my_argv, ros::CallbackQueueInterface *st_queue=NULL, ros::CallbackQueueInterface *mt_queue=NULL) |
|
| Nodelet () |
|
virtual | ~Nodelet () |
|
bool | isValid (const PointCloud2::ConstPtr &cloud, const std::string &topic_name="input") |
|
bool | isValid (const PointCloudConstPtr &cloud, const std::string &topic_name="input") |
|
bool | isValid (const ModelCoefficientsConstPtr &model, const std::string &topic_name="model") |
|
bool | isValid (const PointIndicesConstPtr &indices, const std::string &topic_name="indices") |
|
virtual void | subscribe () |
|
virtual void | unsubscribe () |
|
ros::Publisher | advertise (ros::NodeHandle &nh, std::string topic, int queue_size, bool latch=false) |
|
virtual void | connectionCallback (const ros::SingleSubscriberPublisher &pub) |
|
virtual void | onInitPostProcess () |
|
virtual void | warnNeverSubscribedCallback (const ros::WallTimerEvent &event) |
|
ros::CallbackQueueInterface & | getMTCallbackQueue () const |
|
ros::NodeHandle & | getMTNodeHandle () const |
|
ros::NodeHandle & | getMTPrivateNodeHandle () const |
|
const V_string & | getMyArgv () const |
|
const std::string & | getName () const |
|
ros::NodeHandle & | getNodeHandle () const |
|
ros::NodeHandle & | getPrivateNodeHandle () const |
|
const M_string & | getRemappingArgs () const |
|
ros::CallbackQueueInterface & | getSTCallbackQueue () const |
|
std::string | getSuffixedName (const std::string &suffix) const |
|
Definition at line 66 of file colorize_segmented_RF.h.