#include <ros/ros.h>
#include <signal.h>
#include <sensor_msgs/PointCloud2.h>
#include <object_manipulation_msgs/GraspPlanning.h>
#include <sensor_msgs/point_cloud_conversion.h>
#include <tf/transform_listener.h>
#include <visualization_msgs/Marker.h>
#include <visualization_msgs/MarkerArray.h>
Go to the source code of this file.
Functions | |
tf::Stamped< tf::Pose > | getPoseIn (const char target_frame[], tf::Stamped< tf::Pose >src) |
int | main (int argc, char **argv) |
void | publishMarker (tf::Stamped< tf::Pose > mark) |
tf::Stamped< tf::Pose > | tool2wrist (tf::Stamped< tf::Pose > toolPose, double dist=-.18) |
tf::Stamped< tf::Pose > | wrist2tool (tf::Stamped< tf::Pose > toolPose, double dist=.18) |
Variables | |
tf::TransformListener * | listener_ = 0 |
visualization_msgs::MarkerArray | mar |
int | marker_id = 0 |
int | side_ = 0 |
ros::Publisher | vis_pub |
tf::Stamped<tf::Pose> getPoseIn | ( | const char | target_frame[], |
tf::Stamped< tf::Pose > | src | ||
) |
Definition at line 74 of file GraspClusterClient.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 153 of file GraspClusterClient.cpp.
void publishMarker | ( | tf::Stamped< tf::Pose > | mark | ) |
Definition at line 117 of file GraspClusterClient.cpp.
tf::Stamped<tf::Pose> tool2wrist | ( | tf::Stamped< tf::Pose > | toolPose, |
double | dist = -.18 |
||
) |
Definition at line 43 of file GraspClusterClient.cpp.
tf::Stamped<tf::Pose> wrist2tool | ( | tf::Stamped< tf::Pose > | toolPose, |
double | dist = .18 |
||
) |
Definition at line 57 of file GraspClusterClient.cpp.
Definition at line 72 of file GraspClusterClient.cpp.
visualization_msgs::MarkerArray mar |
Definition at line 115 of file GraspClusterClient.cpp.
int marker_id = 0 |
Definition at line 113 of file GraspClusterClient.cpp.
int side_ = 0 |
Definition at line 41 of file GraspClusterClient.cpp.
Definition at line 114 of file GraspClusterClient.cpp.