5 #include <sensor_msgs/Image.h> 7 #include <sensor_msgs/PointCloud2.h> 8 #include <boost/shared_ptr.hpp> 9 #include <dynamic_reconfigure/server.h> 10 #include <imi_camera/ImiConfig.h> 20 typedef imi_ros_cfg::ImiConfig
Config;
39 void configCb(Config &config, uint32_t level);
image_transport::CameraPublisher pub_color_
dynamic_reconfigure::Server< Config > ReconfigureServer
void newUVCFrameCallback(sensor_msgs::ImagePtr image)
void advertiseROSTopics()
boost::shared_ptr< ReconfigureServer > reconfigure_server_
image_transport::CameraPublisher pub_uvc_
ImiDriver(ros::NodeHandle &n, ros::NodeHandle &pnh)
ros::Publisher pub_cloud_
image_transport::CameraPublisher pub_depth_
void newColorFrameCallback(sensor_msgs::ImagePtr image)
void newCloudPointCallback(boost::shared_ptr< sensor_msgs::PointCloud2 > cloudPtr)
imi_ros_cfg::ImiConfig Config
void newDepthFrameCallback(sensor_msgs::ImagePtr image)
void configCb(Config &config, uint32_t level)