#include "tidyup_utils/planning_scene_interface.h"
#include "tidyup_utils/transformer.h"
#include "tidyup_msgs/GetPutdownPose.h"
#include "tidyup_utils/arm_state.h"
#include <sstream>
Go to the source code of this file.
Functions | |
void | attachObjectToArm (const string &putdown_object, const string &arm) |
int | main (int argc, char *argv[]) |
bool | readPoseFromString (std::stringstream &stream, geometry_msgs::Pose &pose) |
void | writePoseToString (std::stringstream &stream, const geometry_msgs::Pose &pose) |
Variables | |
geometry_msgs::Pose | defaultAttachPose |
geometry_msgs::Pose | robotPose |
string | separator = " " |
void attachObjectToArm | ( | const string & | putdown_object, |
const string & | arm | ||
) |
Definition at line 20 of file test_planning_scene_interface.cpp.
int main | ( | int | argc, |
char * | argv[] | ||
) |
Definition at line 92 of file test_planning_scene_interface.cpp.
bool readPoseFromString | ( | std::stringstream & | stream, |
geometry_msgs::Pose & | pose | ||
) |
Definition at line 72 of file test_planning_scene_interface.cpp.
void writePoseToString | ( | std::stringstream & | stream, |
const geometry_msgs::Pose & | pose | ||
) |
Definition at line 61 of file test_planning_scene_interface.cpp.
Definition at line 16 of file test_planning_scene_interface.cpp.
Definition at line 17 of file test_planning_scene_interface.cpp.
string separator = " " |
Definition at line 18 of file test_planning_scene_interface.cpp.