#include <algorithm>
#include <iostream>
#include <ros/ros.h>
#include <pcl_ros/point_cloud.h>
#include <pcl/point_types.h>
#include "pcl/io/pcd_io.h"
#include "ClearpathDemoTools.h"
#include "geometry_msgs/Twist.h"
Go to the source code of this file.
Defines | |
#define | MAX_RUNTIME_SECONDS 0.1f |
Typedefs | |
typedef pcl::PointCloud < PointType > | PCLPointCloud |
typedef pcl::PointXYZRGB | PointType |
Functions | |
void | callback (const PCLPointCloud::ConstPtr &cloud) |
PCLPointCloud::Ptr | final (new PCLPointCloud) |
int | main (int argc, char **argv) |
Variables | |
double | ang_speed |
double | angular_vel_correction |
double | cam_height |
double | cam_z_trans |
ClearpathDemoTools | demo |
double | lin_speed |
ros::Publisher | pub |
int | publish_visualization = 1 |
ros::Publisher | pubvel |
int | random_walk = 0 |
double | wall_buffer |
#define MAX_RUNTIME_SECONDS 0.1f |
Definition at line 12 of file ClearpathDemoExplore.cpp.
typedef pcl::PointCloud<PointType> PCLPointCloud |
Definition at line 16 of file ClearpathDemoExplore.cpp.
typedef pcl::PointXYZRGB PointType |
Definition at line 15 of file ClearpathDemoExplore.cpp.
void callback | ( | const PCLPointCloud::ConstPtr & | cloud | ) |
Definition at line 39 of file ClearpathDemoExplore.cpp.
PCLPointCloud::Ptr final | ( | new | PCLPointCloud | ) |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 86 of file ClearpathDemoExplore.cpp.
double ang_speed |
Definition at line 24 of file ClearpathDemoExplore.cpp.
double angular_vel_correction |
Definition at line 28 of file ClearpathDemoExplore.cpp.
double cam_height |
Definition at line 25 of file ClearpathDemoExplore.cpp.
double cam_z_trans |
Definition at line 26 of file ClearpathDemoExplore.cpp.
Definition at line 33 of file ClearpathDemoExplore.cpp.
double lin_speed |
Definition at line 23 of file ClearpathDemoExplore.cpp.
Definition at line 19 of file ClearpathDemoExplore.cpp.
int publish_visualization = 1 |
Definition at line 29 of file ClearpathDemoExplore.cpp.
Definition at line 20 of file ClearpathDemoExplore.cpp.
int random_walk = 0 |
Definition at line 30 of file ClearpathDemoExplore.cpp.
double wall_buffer |
Definition at line 27 of file ClearpathDemoExplore.cpp.