#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.
| Functions | |
| int | main (int argc, char **argv) | 
| void | syncCloudHandler (const sensor_msgs::Image::ConstPtr &syncCloud2) | 
| void | voDataHandler (const nav_msgs::Odometry::ConstPtr &voData) | 
| Variables | |
| int | cloudCount = -1 | 
| int | cloudRegInd = 0 | 
| const int | cloudSkipNum = 5 | 
| const int | imagePixelNum = imageHeight * imageWidth | 
| const int | keepSyncCloudNum = 15 | 
| const double | PI = 3.1415926 | 
| double | rxRec = 0 | 
| double | ryRec = 0 | 
| double | rzRec = 0 | 
| int | showCount = -1 | 
| const int | showSkipNum = 10 | 
| pcl::PointCloud< pcl::PointXYZ > ::Ptr | surroundCloud (new pcl::PointCloud< pcl::PointXYZ >()) | 
| ros::Publisher * | surroundCloudPubPointer = NULL | 
| pcl::PointCloud< pcl::PointXYZ > ::Ptr | syncCloudArray [keepSyncCloudNum] | 
| int | syncCloudInd = -1 | 
| double | syncCloudTime [keepSyncCloudNum] = {0} | 
| pcl::PointCloud< pcl::PointXYZ > ::Ptr | tempCloud (new pcl::PointCloud< pcl::PointXYZ >()) | 
| pcl::PointCloud< pcl::PointXYZ > ::Ptr | tempCloud2 (new pcl::PointCloud< pcl::PointXYZ >()) | 
| double | timeRec = 0 | 
| double | txRec = 0 | 
| double | tyRec = 0 | 
| double | tzRec = 0 | 
| int main | ( | int | argc, | 
| char ** | argv | ||
| ) | 
Definition at line 199 of file registerPointCloud.cpp.
| void syncCloudHandler | ( | const sensor_msgs::Image::ConstPtr & | syncCloud2 | ) | 
Definition at line 157 of file registerPointCloud.cpp.
| void voDataHandler | ( | const nav_msgs::Odometry::ConstPtr & | voData | ) | 
Definition at line 41 of file registerPointCloud.cpp.
| int cloudCount = -1 | 
Definition at line 33 of file registerPointCloud.cpp.
| int cloudRegInd = 0 | 
Definition at line 23 of file registerPointCloud.cpp.
| const int cloudSkipNum = 5 | 
Definition at line 34 of file registerPointCloud.cpp.
| const int imagePixelNum = imageHeight * imageWidth | 
Definition at line 17 of file registerPointCloud.cpp.
| const int keepSyncCloudNum = 15 | 
Definition at line 19 of file registerPointCloud.cpp.
| const double PI = 3.1415926 | 
Definition at line 15 of file registerPointCloud.cpp.
| double rxRec = 0 | 
Definition at line 30 of file registerPointCloud.cpp.
| double ryRec = 0 | 
Definition at line 30 of file registerPointCloud.cpp.
| double rzRec = 0 | 
Definition at line 30 of file registerPointCloud.cpp.
| int showCount = -1 | 
Definition at line 36 of file registerPointCloud.cpp.
| const int showSkipNum = 10 | 
Definition at line 37 of file registerPointCloud.cpp.
| pcl::PointCloud<pcl::PointXYZ>::Ptr surroundCloud(new pcl::PointCloud< pcl::PointXYZ >()) | 
Definition at line 39 of file registerPointCloud.cpp.
Definition at line 21 of file registerPointCloud.cpp.
| int syncCloudInd = -1 | 
Definition at line 22 of file registerPointCloud.cpp.
| double syncCloudTime[keepSyncCloudNum] = {0} | 
Definition at line 20 of file registerPointCloud.cpp.
| pcl::PointCloud<pcl::PointXYZ>::Ptr tempCloud(new pcl::PointCloud< pcl::PointXYZ >()) | 
| pcl::PointCloud<pcl::PointXYZ>::Ptr tempCloud2(new pcl::PointCloud< pcl::PointXYZ >()) | 
| double timeRec = 0 | 
Definition at line 29 of file registerPointCloud.cpp.
| double txRec = 0 | 
Definition at line 31 of file registerPointCloud.cpp.
| double tyRec = 0 | 
Definition at line 31 of file registerPointCloud.cpp.
| double tzRec = 0 | 
Definition at line 31 of file registerPointCloud.cpp.