#include <ros/ros.h>#include <mapping_msgs/AttachedCollisionObject.h>#include <string>#include <vector>#include <ostream>#include "ros/serialization.h"#include "ros/builtin_message_traits.h"#include "ros/message_operations.h"#include "ros/message.h"#include "ros/time.h"#include "mapping_msgs/CollisionObject.h"#include <geometric_shapes_msgs/Shape.h>#include <stdint.h>#include <boost/shared_array.hpp>#include <stdexcept>#include <cstdlib>#include "geometric_shapes/shapes.h"#include "btScalar.h"#include "btMinMax.h"#include "aiTypes.h"

Go to the source code of this file.
Functions | |
| bool | getTrianglesFromMeshFile (std::string mesh_file, std::vector< int32_t > &triangles, std::vector< geometry_msgs::Point > &vertices) |
| int | main (int argc, char **argv) |
| bool getTrianglesFromMeshFile | ( | std::string | mesh_file, | |
| std::vector< int32_t > & | triangles, | |||
| std::vector< geometry_msgs::Point > & | vertices | |||
| ) |
Definition at line 8 of file attach_object_to_right_gripper.cpp.
| int main | ( | int | argc, | |
| char ** | argv | |||
| ) |
Definition at line 66 of file attach_object_to_right_gripper.cpp.