Typedefs | Functions | Variables
scanning.cpp File Reference
#include <ros/ros.h>
#include <ros/service.h>
#include <tf/transform_listener.h>
#include <tf_conversions/tf_eigen.h>
#include <eigen_conversions/eigen_msg.h>
#include <std_msgs/String.h>
#include <moveit/move_group_interface/move_group_interface.h>
#include <moveit_msgs/ExecuteKnownTrajectory.h>
#include <yaml-cpp/exceptions.h>
#include <yaml-cpp/mark.h>
#include "yaml_utils.h"
#include <fanuc_grinding_scanning/ScanningService.h>
#include <fanuc_grinding_publish_meshfile/PublishMeshfileService.h>
#include <pcl/point_cloud.h>
#include <pcl/common/colors.h>
#include <pcl/common/transforms.h>
#include <pcl/io/davidsdk_grabber.h>
#include <pcl/io/ply_io.h>
#include <pcl/filters/voxel_grid.h>
Include dependency graph for scanning.cpp:

Go to the source code of this file.

Typedefs

typedef pcl::PointCloud< PointXYZPointCloudXYZ
 
typedef pcl::PointXYZ PointXYZ
 

Functions

bool executeJointState (const std::vector< double > joint_states)
 
int main (int argc, char **argv)
 
bool moveRobotScan (fanuc_grinding_scanning::ScanningService::Request &req, fanuc_grinding_scanning::ScanningService::Response &res)
 

Variables

pcl::DavidSDKGrabber::Ptr davidsdk_ptr
 
boost::shared_ptr< moveit::planning_interface::MoveGroupInterfacegroup
 
boost::shared_ptr< ros::NodeHandlenode
 
boost::shared_ptr< ros::Publisherstatus_pub
 

Typedef Documentation

Definition at line 34 of file scanning.cpp.

typedef pcl::PointXYZ PointXYZ

Definition at line 33 of file scanning.cpp.

Function Documentation

bool executeJointState ( const std::vector< double >  joint_states)

Move the robot to a set of joint values

Parameters
[in]joint_states
Returns
True if successful, false otherwise

Definition at line 47 of file scanning.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 309 of file scanning.cpp.

bool moveRobotScan ( fanuc_grinding_scanning::ScanningService::Request &  req,
fanuc_grinding_scanning::ScanningService::Response &  res 
)

This is the service function that is called whenever a request is received

Parameters
req[int]
res[out]
Returns
Always true

Definition at line 62 of file scanning.cpp.

Variable Documentation

pcl::DavidSDKGrabber::Ptr davidsdk_ptr

Definition at line 31 of file scanning.cpp.

Definition at line 37 of file scanning.cpp.

Definition at line 36 of file scanning.cpp.

Status publisher

Definition at line 40 of file scanning.cpp.



scanning
Author(s): Kévin Bolloré, Victor Lamoine - Institut Maupertuis
autogenerated on Thu Dec 19 2019 03:38:24