50 #include <sensor_msgs/Image.h> 51 #include <sensor_msgs/PointCloud2.h> 56 main (
int argc,
char **argv)
58 ros::init (argc, argv,
"image_publisher");
64 std::cout <<
"usage:\n" << argv[0] <<
" cloud.pcd" << std::endl;
68 sensor_msgs::Image image;
69 sensor_msgs::PointCloud2 cloud;
76 catch (std::runtime_error &e)
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
void publish(const boost::shared_ptr< M > &message) const
int loadPCDFile(const std::string &file_name, sensor_msgs::PointCloud2 &cloud)
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
void toROSMsg(const sensor_msgs::PointCloud2 &cloud, sensor_msgs::Image &image)
int main(int argc, char **argv)
#define ROS_ERROR_STREAM(args)
ROSCPP_DECL void spinOnce()