Adds the current environment as a known obstacle to the environment server. More...
#include <ros/ros.h>
#include <stdio.h>
#include <vector>
#include <mapping_msgs/CollisionObject.h>
#include <geometric_shapes_msgs/Shape.h>
#include <tinyxml/tinyxml.h>
#include <ctype.h>
#include <stdlib.h>
#include <string.h>
#include <assert.h>
#include "tinystr.h"
#include <string>
#include <map>
#include <tinyxml/tinyxml.h>
#include <boost/function.hpp>
#include "link.h"
#include <cstdlib>
#include <urdf/model.h>
#include "btMatrix3x3.h"
#include <boost/thread/shared_mutex.hpp>
#include <iostream>
#include <boost/bimap.hpp>
#include <iomanip>
#include <cmath>
#include <sstream>
#include <stdexcept>
#include <list>
#include <boost/thread/mutex.hpp>
#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 "std_msgs/Header.h"
#include "geometry_msgs/Point.h"
#include "geometry_msgs/Vector3.h"
#include "geometry_msgs/Quaternion.h"
#include "geometry_msgs/Pose.h"
#include "LinearMath/btTransform.h"
#include "ros/console.h"
#include "tf/exceptions.h"
#include <boost/signals.hpp>
#include "geometry_msgs/Twist.h"
#include <geometric_shapes/shapes.h>
#include <gazebo/GetModelState.h>
Go to the source code of this file.
Functions | |
shapes::Shape * | constructShape (const urdf::Geometry *geom) |
int | main (int argc, char **argv) |
Adds the current environment as a known obstacle to the environment server.
Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met:
This program is free software: you can redistribute it and/or modify it under the terms of the GNU Lesser General Public License LGPL as published by the Free Software Foundation, either version 3 of the License, or (at your option) any later version.
This program is distributed in the hope that it will be useful, but WITHOUT ANY WARRANTY; without even the implied warranty of MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE. See the GNU Lesser General Public License LGPL for more details.
You should have received a copy of the GNU Lesser General Public License LGPL along with this program. If not, see <http://www.gnu.org/licenses/>.
Definition in file addWorld.cpp.
shapes::Shape* constructShape | ( | const urdf::Geometry * | geom | ) |
Definition at line 75 of file addWorld.cpp.
int main | ( | int | argc, | |
char ** | argv | |||
) |
Definition at line 110 of file addWorld.cpp.