18 #ifndef DEPTH_ODOMETRY_DEPTH_ODOMETRY_NODELET_H_
19 #define DEPTH_ODOMETRY_DEPTH_ODOMETRY_NODELET_H_
22 #include <ff_msgs/SetBool.h>
25 #include <image_transport/image_transport.h>
27 #include <sensor_msgs/PointCloud2.h>
28 #include <ros/node_handle.h>
29 #include <ros/publisher.h>
30 #include <ros/subscriber.h>
38 void Initialize(ros::NodeHandle* nh)
final;
39 void SubscribeAndAdvertise(ros::NodeHandle* nh);
40 void PointCloudCallback(
const sensor_msgs::PointCloud2ConstPtr& point_cloud_msg);
41 void ImageCallback(
const sensor_msgs::ImageConstPtr& image_msg);
42 bool EnableService(ff_msgs::SetBool::Request& req, ff_msgs::SetBool::Response& res);
45 image_transport::Subscriber image_sub_;
46 ros::Subscriber point_cloud_sub_;
47 ros::Publisher depth_odometry_pub_;
48 ros::ServiceServer enable_srv_;
53 #endif // DEPTH_ODOMETRY_DEPTH_ODOMETRY_NODELET_H_