#include <math.h>#include <stdio.h>#include <stdlib.h>#include <ros/ros.h>#include <nav_msgs/Odometry.h>#include <tf/transform_datatypes.h>#include <tf/transform_listener.h>#include <tf/transform_broadcaster.h>#include "cameraParameters.h"#include "pointDefinition.h"
Go to the source code of this file.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 276 of file processDepthmap.cpp.
| void syncCloudHandler | ( | const sensor_msgs::Image::ConstPtr & | syncCloud2 | ) |
Definition at line 213 of file processDepthmap.cpp.
| void voDataHandler | ( | const nav_msgs::Odometry::ConstPtr & | voData | ) |
Definition at line 43 of file processDepthmap.cpp.
| int cloudCount = -1 |
Definition at line 37 of file processDepthmap.cpp.
| const int cloudDSRate = 5 |
Definition at line 39 of file processDepthmap.cpp.
| int cloudRegInd = 0 |
Definition at line 23 of file processDepthmap.cpp.
| const int cloudSkipNum = 5 |
Definition at line 38 of file processDepthmap.cpp.
| pcl::PointCloud<pcl::PointXYZI>::Ptr depthCloud(new pcl::PointCloud< pcl::PointXYZI >()) |
| ros::Publisher* depthCloudPubPointer = NULL |
Definition at line 41 of file processDepthmap.cpp.
| const int imagePixelNum = imageHeight * imageWidth |
Definition at line 17 of file processDepthmap.cpp.
| double initTime |
Definition at line 35 of file processDepthmap.cpp.
| const int keepSyncCloudNum = 5 |
Definition at line 19 of file processDepthmap.cpp.
| const double PI = 3.1415926 |
Definition at line 15 of file processDepthmap.cpp.
| double rxRec = 0 |
Definition at line 31 of file processDepthmap.cpp.
| double ryRec = 0 |
Definition at line 31 of file processDepthmap.cpp.
| double rzRec = 0 |
Definition at line 31 of file processDepthmap.cpp.
Definition at line 21 of file processDepthmap.cpp.
| int syncCloudInd = -1 |
Definition at line 22 of file processDepthmap.cpp.
| double syncCloudTime[keepSyncCloudNum] = {0} |
Definition at line 20 of file processDepthmap.cpp.
| bool systemInited = false |
Definition at line 34 of file processDepthmap.cpp.
| pcl::PointCloud<pcl::PointXYZI>::Ptr tempCloud(new pcl::PointCloud< pcl::PointXYZI >()) |
| pcl::PointCloud<pcl::PointXYZI>::Ptr tempCloud2(new pcl::PointCloud< pcl::PointXYZI >()) |
| pcl::PointCloud<pcl::PointXYZI>::Ptr tempCloud3(new pcl::PointCloud< pcl::PointXYZI >()) |
| double timeRec = 0 |
Definition at line 30 of file processDepthmap.cpp.
| double txRec = 0 |
Definition at line 32 of file processDepthmap.cpp.
| double tyRec = 0 |
Definition at line 32 of file processDepthmap.cpp.
| double tzRec = 0 |
Definition at line 32 of file processDepthmap.cpp.