#include <fpfh_node.h>
Public Member Functions | |
bool | fpfh_srv_cb (feature_extractor_fpfh::FPFHCalc::Request &, feature_extractor_fpfh::FPFHCalc::Response &) |
FPFHNode (ros::NodeHandle &) | |
void | message_cb (const sensor_msgs::Image::ConstPtr &, const sensor_msgs::PointCloud2::ConstPtr &) |
void | process_point_cloud (const sensor_msgs::PointCloud2::ConstPtr &, feature_extractor_fpfh::FPFHHist &) |
bool | subsample_srv_cb (feature_extractor_fpfh::SubsampleCalc::Request &, feature_extractor_fpfh::SubsampleCalc::Response &) |
Protected Attributes | |
ros::ServiceServer | fpfh_service |
ros::Publisher | hist_publisher |
ros::NodeHandle | n_ |
ros::ServiceServer | subsample_service |
Definition at line 10 of file fpfh_node.h.
Definition at line 28 of file fpfh_node.cpp.
bool FPFHNode::fpfh_srv_cb | ( | feature_extractor_fpfh::FPFHCalc::Request & | req, |
feature_extractor_fpfh::FPFHCalc::Response & | res | ||
) |
Definition at line 36 of file fpfh_node.cpp.
void FPFHNode::message_cb | ( | const sensor_msgs::Image::ConstPtr & | image, |
const sensor_msgs::PointCloud2::ConstPtr & | input_cloud | ||
) |
Definition at line 189 of file fpfh_node.cpp.
void FPFHNode::process_point_cloud | ( | const sensor_msgs::PointCloud2::ConstPtr & | input_cloud, |
feature_extractor_fpfh::FPFHHist & | hist | ||
) |
Definition at line 78 of file fpfh_node.cpp.
bool FPFHNode::subsample_srv_cb | ( | feature_extractor_fpfh::SubsampleCalc::Request & | req, |
feature_extractor_fpfh::SubsampleCalc::Response & | res | ||
) |
Definition at line 55 of file fpfh_node.cpp.
ros::ServiceServer FPFHNode::fpfh_service [protected] |
Definition at line 15 of file fpfh_node.h.
ros::Publisher FPFHNode::hist_publisher [protected] |
Definition at line 14 of file fpfh_node.h.
ros::NodeHandle FPFHNode::n_ [protected] |
Definition at line 13 of file fpfh_node.h.
ros::ServiceServer FPFHNode::subsample_service [protected] |
Definition at line 16 of file fpfh_node.h.