#include <stdio.h>#include <ros/ros.h>#include <visualization_msgs/Marker.h>#include <sensor_msgs/LaserScan.h>#include <sensor_msgs/PointCloud2.h>#include <tf/transform_listener.h>#include <pcl_ros/transforms.h>#include <pcl/conversions.h>#include <pcl/point_cloud.h>#include <pcl/point_types.h>#include <pcl/segmentation/extract_polygonal_prism_data.h>#include <pcl/filters/extract_indices.h>#include <pcl/filters/project_inliers.h>#include <pcl/filters/voxel_grid.h>#include <points_from_volume/points_from_volume.h>
Go to the source code of this file.
Macros | |
| #define | PFLN printf("FILE %s LINE %d\n",__FILE__, __LINE__); |
| Modulation of the Kinect Hz of published pointclouds. More... | |
Functions | |
| void | conversion (const sensor_msgs::PointCloud2ConstPtr &pcmsg_in) |
| Point cloud treatment. More... | |
| int | main (int argc, char **argv) |
| Publish messages at a certain loop rate. More... | |
Variables | |
| ros::Publisher | cloud_pub |
| ros::NodeHandle * | p_n |
| #define PFLN printf("FILE %s LINE %d\n",__FILE__, __LINE__); |
Modulation of the Kinect Hz of published pointclouds.
Receive the point cloud from the Kinect sensor, but publishes only at a defined rate
Definition at line 49 of file kinect_freq_mod.cpp.
| void conversion | ( | const sensor_msgs::PointCloud2ConstPtr & | pcmsg_in | ) |
Point cloud treatment.
This function cuts the point cloud at a certain distance
| PointCloud | message received from the Kinect sensor |
Definition at line 64 of file kinect_freq_mod.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Publish messages at a certain loop rate.
| int | argc |
| char | **argv |
Definition at line 95 of file kinect_freq_mod.cpp.
| ros::Publisher cloud_pub |
Definition at line 55 of file kinect_freq_mod.cpp.
| ros::NodeHandle* p_n |
Definition at line 56 of file kinect_freq_mod.cpp.