#include <visualization_msgs/InteractiveMarker.h>
#include <geometry_msgs/PoseStamped.h>
#include <std_msgs/ColorRGBA.h>
Go to the source code of this file.
|
void | robot_interaction::add6DOFControl (visualization_msgs::InteractiveMarker &int_marker, bool orientation_fixed=false) |
|
void | robot_interaction::addErrorMarker (visualization_msgs::InteractiveMarker &im) |
|
void | robot_interaction::addOrientationControl (visualization_msgs::InteractiveMarker &int_marker, bool orientation_fixed=false) |
|
void | robot_interaction::addPlanarXYControl (visualization_msgs::InteractiveMarker &int_marker, bool orientation_fixed=false) |
|
void | robot_interaction::addPositionControl (visualization_msgs::InteractiveMarker &int_marker, bool orientation_fixed=false) |
|
void | robot_interaction::addTArrowMarker (visualization_msgs::InteractiveMarker &im) |
|
void | robot_interaction::addViewPlaneControl (visualization_msgs::InteractiveMarker &int_marker, double radius, const std_msgs::ColorRGBA &color, bool position=true, bool orientation=true) |
|
visualization_msgs::InteractiveMarker | robot_interaction::make6DOFMarker (const std::string &name, const geometry_msgs::PoseStamped &stamped, double scale, bool orientation_fixed=false) |
|
visualization_msgs::InteractiveMarker | robot_interaction::makeEmptyInteractiveMarker (const std::string &name, const geometry_msgs::PoseStamped &stamped, double scale) |
|
visualization_msgs::InteractiveMarker | robot_interaction::makePlanarXYMarker (const std::string &name, const geometry_msgs::PoseStamped &stamped, double scale, bool orientation_fixed=false) |
|