37 #include <jsk_footstep_planner/PointCloudModelGeneratorConfig.h> 38 #include <sensor_msgs/PointCloud2.h> 40 #include <dynamic_reconfigure/server.h> 55 int main(
int argc,
char** argv)
57 ros::init(argc, argv,
"pointcloud_model_generator_node");
61 dynamic_reconfigure::Server<PointCloudModelGeneratorConfig>
server;
69 pcl::PointCloud<pcl::PointNormal>
cloud;
71 sensor_msgs::PointCloud2 ros_cloud;
73 ros_cloud.header.frame_id =
"odom";
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
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
void reconfigureCallback(PointCloudModelGeneratorConfig &config, uint32_t level)
void toROSMsg(const sensor_msgs::PointCloud2 &cloud, sensor_msgs::Image &image)
int main(int argc, char **argv)
ROSCPP_DECL void spinOnce()