Typedef robot_interaction::InteractiveMarkerUpdateFn

Typedef Documentation

typedef std::function<bool(const moveit::core::RobotState&, geometry_msgs::msg::Pose&)> robot_interaction::InteractiveMarkerUpdateFn

Type of function for updating marker pose for new state. This callback is called when the robot state has changed. Callback should calculate a new pose for the marker based on the passed in robot state.

Param state:

the new state of the robot

Param pose:

the function should fill this in with the new pose of the marker, given the new state of the robot.

Return:

true if the pose was modified, false if no update is needed (i.e. if the pose did not change).