Functions | Variables
objects_handler.cpp File Reference
#include <ros/ros.h>
#include <std_srvs/SetBool.h>
#include <geometry_msgs/PoseStamped.h>
#include <geometry_msgs/Pose.h>
#include <ar_track_alvar_msgs/AlvarMarkers.h>
#include <moveit/planning_scene_interface/planning_scene_interface.h>
#include <moveit_msgs/CollisionObject.h>
#include <iostream>
#include <sstream>
#include "tf/tf.h"
Include dependency graph for objects_handler.cpp:

Go to the source code of this file.

Functions

std::string get_obj_id (int id)
geometry_msgs::Pose get_obj_position (int id, geometry_msgs::Pose pose)
shape_msgs::SolidPrimitive get_obj_shape (int id)
void handle_objects (const ar_track_alvar_msgs::AlvarMarkers::ConstPtr &markers)
int main (int argc, char **argv)
bool update_cb (std_srvs::SetBool::Request &req, std_srvs::SetBool::Response &res)

Variables

moveit::planning_interface::PlanningSceneInterfaceplanning_scene_interface_ptr
bool update = false

Function Documentation

std::string get_obj_id ( int  id)

Definition at line 58 of file objects_handler.cpp.

Definition at line 89 of file objects_handler.cpp.

shape_msgs::SolidPrimitive get_obj_shape ( int  id)

Definition at line 70 of file objects_handler.cpp.

void handle_objects ( const ar_track_alvar_msgs::AlvarMarkers::ConstPtr &  markers)

Definition at line 95 of file objects_handler.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 30 of file objects_handler.cpp.

bool update_cb ( std_srvs::SetBool::Request &  req,
std_srvs::SetBool::Response &  res 
)

Definition at line 120 of file objects_handler.cpp.


Variable Documentation

Definition at line 25 of file objects_handler.cpp.

bool update = false

Definition at line 21 of file objects_handler.cpp.



robotican_common
Author(s):
autogenerated on Fri Oct 27 2017 03:02:37