#include <ros/ros.h>
#include <OgreVector3.h>
#include <srs_ui_but/topics_list.h>
#include <srs_ui_but/services_list.h>
#include <srs_ui_but/ButCamMsg.h>
#include <visualization_msgs/Marker.h>
#include <sensor_msgs/Image.h>
#include <sensor_msgs/PointCloud2.h>
#include <sensor_msgs/CameraInfo.h>
#include <sensor_msgs/image_encodings.h>
#include <message_filters/subscriber.h>
#include <message_filters/synchronizer.h>
#include <message_filters/sync_policies/approximate_time.h>
#include <pcl_ros/point_cloud.h>
#include <pcl_ros/transforms.h>
#include <tf/transform_listener.h>
#include <tf/message_filter.h>
#include <stdio.h>
#include <utility>
#include <sstream>
#include <float.h>
Go to the source code of this file.
Define Documentation
Function Documentation
void callback1 |
( |
const CameraInfoConstPtr & |
cam_info | ) |
|
void callback2 |
( |
const PointCloud2ConstPtr & |
pcl | ) |
|
pair< float, float > countPclDepths |
( |
const PointCloud2ConstPtr & |
pcl | ) |
|
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
Publishes message with camera display geometry.
- Parameters:
-
cam_info | Given camera info |
display_depth | Chosen depth of camera display |
Definition at line 186 of file view.cpp.
Publishes the marker representing view frustum.
- Parameters:
-
cam_info | given CameraInfo |
frustum_deph | chosen depth of view frustum lines |
Definition at line 266 of file view.cpp.
Updates subscriber for camera parameters according to set topic camera_topic_par.
- Parameters:
-
Definition at line 148 of file view.cpp.
Variable Documentation