19 #include "leica_scanstation_utils/LeicaUtils.h" 26 int main(
int argc,
char** argv)
35 sensor_msgs::PointCloud2ConstPtr cloud_msg;
37 pcl::fromROSMsg(*cloud_msg, *source_cloud);
41 pcl::fromROSMsg(*cloud_msg, *target_cloud);
46 std::shared_ptr<StateMachine> FSM = std::make_shared<StateMachine>(source_cloud, target_cloud, nh);
pcl::PointCloud< pcl::PointXYZRGB > PointCloudRGB
const std::string SOURCE_CLOUD_TOPIC
pcl::PointCloud< pcl::PointXYZ > PointCloudXYZ
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
static bool isValidCloud(PointCloudXYZ::Ptr cloud)
Check whether cloud contains data and is not empty.
ROSCPP_DECL void spin(Spinner &spinner)
const std::string TARGET_CLOUD_TOPIC
pcl::PointCloud< pcl::PointXYZRGB > PointCloudRGB
int main(int argc, char **argv)
ROSCPP_DECL void spinOnce()