#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 "pointDefinition.h"
Go to the source code of this file.
Functions | |
int | main (int argc, char **argv) |
void | syncCloudHandler (const sensor_msgs::PointCloud2ConstPtr &syncCloud2) |
void | voDataHandler (const nav_msgs::Odometry::ConstPtr &voData) |
Variables | |
const int | keepVoDataNum = 30 |
const double | PI = 3.1415926 |
int | showCount = -1 |
const int | showSkipNum = 15 |
int | startCount = -1 |
const int | startSkipNum = 5 |
pcl::PointCloud< pcl::PointXYZ > ::Ptr | surroundCloud (new pcl::PointCloud< pcl::PointXYZ >()) |
ros::Publisher * | surroundCloudPubPointer = NULL |
pcl::PointCloud< pcl::PointXYZ > ::Ptr | syncCloud (new pcl::PointCloud< pcl::PointXYZ >()) |
pcl::PointCloud< pcl::PointXYZ > ::Ptr | tempCloud (new pcl::PointCloud< pcl::PointXYZ >()) |
int | voDataInd = -1 |
double | voDataTime [keepVoDataNum] = {0} |
int | voRegInd = 0 |
double | voRx [keepVoDataNum] = {0} |
double | voRy [keepVoDataNum] = {0} |
double | voRz [keepVoDataNum] = {0} |
double | voTx [keepVoDataNum] = {0} |
double | voTy [keepVoDataNum] = {0} |
double | voTz [keepVoDataNum] = {0} |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 178 of file registerPointCloud.cpp.
void syncCloudHandler | ( | const sensor_msgs::PointCloud2ConstPtr & | syncCloud2 | ) |
Definition at line 61 of file registerPointCloud.cpp.
void voDataHandler | ( | const nav_msgs::Odometry::ConstPtr & | voData | ) |
Definition at line 39 of file registerPointCloud.cpp.
const int keepVoDataNum = 30 |
Definition at line 16 of file registerPointCloud.cpp.
const double PI = 3.1415926 |
Definition at line 14 of file registerPointCloud.cpp.
int showCount = -1 |
Definition at line 34 of file registerPointCloud.cpp.
const int showSkipNum = 15 |
Definition at line 35 of file registerPointCloud.cpp.
int startCount = -1 |
Definition at line 31 of file registerPointCloud.cpp.
const int startSkipNum = 5 |
Definition at line 32 of file registerPointCloud.cpp.
pcl::PointCloud<pcl::PointXYZ>::Ptr surroundCloud(new pcl::PointCloud< pcl::PointXYZ >()) |
Definition at line 37 of file registerPointCloud.cpp.
pcl::PointCloud<pcl::PointXYZ>::Ptr syncCloud(new pcl::PointCloud< pcl::PointXYZ >()) |
pcl::PointCloud<pcl::PointXYZ>::Ptr tempCloud(new pcl::PointCloud< pcl::PointXYZ >()) |
int voDataInd = -1 |
Definition at line 24 of file registerPointCloud.cpp.
double voDataTime[keepVoDataNum] = {0} |
Definition at line 17 of file registerPointCloud.cpp.
int voRegInd = 0 |
Definition at line 25 of file registerPointCloud.cpp.
double voRx[keepVoDataNum] = {0} |
Definition at line 18 of file registerPointCloud.cpp.
double voRy[keepVoDataNum] = {0} |
Definition at line 19 of file registerPointCloud.cpp.
double voRz[keepVoDataNum] = {0} |
Definition at line 20 of file registerPointCloud.cpp.
double voTx[keepVoDataNum] = {0} |
Definition at line 21 of file registerPointCloud.cpp.
double voTy[keepVoDataNum] = {0} |
Definition at line 22 of file registerPointCloud.cpp.
double voTz[keepVoDataNum] = {0} |
Definition at line 23 of file registerPointCloud.cpp.