#include <geometric_shapes/body_operations.h>
#include <geometric_shapes/shape_operations.h>
#include <console_bridge/console.h>
#include <Eigen/Geometry>
Go to the source code of this file.
Namespaces | |
namespace | bodies |
This set of classes allows quickly detecting whether a given point is inside an object or not. This capability is useful when removing points from inside the robot (when the robot sees its arms, for example). | |
Functions | |
template<typename T > | |
Body * | bodies::constructBodyFromMsgHelper (const T &shape_msg, const geometry_msgs::Pose &pose) |