This file has the main functionalities of foveation control. More...
#include <stdio.h>#include <ros/ros.h>#include <laser_geometry/laser_geometry.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 <sensor_msgs/JointState.h>#include <pcl_conversions/pcl_conversions.h>
Go to the source code of this file.
Macros | |
| #define | _USE_DEBUG_ 0 |
| #define | PFLN printf("file %s line %d\n",__FILE__,__LINE__); |
Functions | |
| int | main (int argc, char **argv) |
| void | target_pose_cb (const sensor_msgs::PointCloud2ConstPtr &pcmsg_in) |
Variables | |
| double | current_pan =0 |
| double | current_tilt =0 |
| tf::TransformListener * | p_listener |
| ros::NodeHandle * | p_n |
| ros::Publisher | pub |
This file has the main functionalities of foveation control.
Definition in file main.cpp.
| void target_pose_cb | ( | const sensor_msgs::PointCloud2ConstPtr & | pcmsg_in | ) |