Go to the documentation of this file.
   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)
 
  
#define ROS_ERROR_STREAM(args)
ROSCPP_DECL void init(const M_string &remappings, const std::string &name, uint32_t options=0)
ROSCPP_DECL void spinOnce()
void publish(const boost::shared_ptr< M > &message) const
Publisher advertise(AdvertiseOptions &ops)
int main(int argc, char **argv)
int loadPCDFile(const std::string &file_name, sensor_msgs::PointCloud2 &cloud)
void toROSMsg(const pcl::PointCloud< T > &cloud, sensor_msgs::Image &msg)
pcl_ros
Author(s): Open Perception, Julius Kammerl 
, William Woodall 
autogenerated on Fri Jul 12 2024 02:54:40