moveit2
The MoveIt Motion Planning Framework for ROS 2.
Namespaces | Functions
interactive_marker_helpers.h File Reference
#include <visualization_msgs/msg/interactive_marker.hpp>
#include <geometry_msgs/msg/pose_stamped.hpp>
#include <std_msgs/msg/color_rgba.hpp>
Include dependency graph for interactive_marker_helpers.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Namespaces

 robot_interaction
 

Functions

visualization_msgs::msg::InteractiveMarker robot_interaction::makeEmptyInteractiveMarker (const std::string &name, const geometry_msgs::msg::PoseStamped &stamped, double scale)
 
visualization_msgs::msg::InteractiveMarker robot_interaction::make6DOFMarker (const std::string &name, const geometry_msgs::msg::PoseStamped &stamped, double scale, bool orientation_fixed=false)
 
visualization_msgs::msg::InteractiveMarker robot_interaction::makePlanarXYMarker (const std::string &name, const geometry_msgs::msg::PoseStamped &stamped, double scale, bool orientation_fixed=false)
 
void robot_interaction::addTArrowMarker (visualization_msgs::msg::InteractiveMarker &im)
 
void robot_interaction::addErrorMarker (visualization_msgs::msg::InteractiveMarker &im)
 
void robot_interaction::add6DOFControl (visualization_msgs::msg::InteractiveMarker &int_marker, bool orientation_fixed=false)
 
void robot_interaction::addPlanarXYControl (visualization_msgs::msg::InteractiveMarker &int_marker, bool orientation_fixed=false)
 
void robot_interaction::addOrientationControl (visualization_msgs::msg::InteractiveMarker &int_marker, bool orientation_fixed=false)
 
void robot_interaction::addPositionControl (visualization_msgs::msg::InteractiveMarker &int_marker, bool orientation_fixed=false)
 
void robot_interaction::addViewPlaneControl (visualization_msgs::msg::InteractiveMarker &int_marker, double radius, const std_msgs::msg::ColorRGBA &color, bool position=true, bool orientation=true)