Public Member Functions | Public Attributes | Protected Attributes
planning_scene_utils::MotionPlanRequestData Class Reference

Convenience class wrapping a motion plan request and its meta-data. More...

#include <move_arm_utils.h>

List of all members.

Public Member Functions

void addTrajectoryId (unsigned int id)
bool areCollisionsVisible () const
 Return whether or not the small red spheres corresponding to collision points are being published.
bool areJointControlsVisible () const
 returns whether the interactive joint control markers are visible.
visualization_msgs::MarkerArray & getCollisionMarkers ()
 Each motion plan request stores an array of small red spheres corresponding to collision points.
bool getConstrainPitch () const
bool getConstrainRoll () const
bool getConstrainYaw () const
std::string getEndEffectorLink () const
 Returns the name of the link that IK is performed for.
const std_msgs::ColorRGBA & getGoalColor () const
 Returns the color of the markers of the goal position.
planning_models::KinematicStategetGoalState ()
 Returns a KinematicState pointer corresponding to the goal joint constraints of the robot.
std::string getGroupName () const
 Returns the name of the planning group associated with the motion plan request (usually, right or left arm)
unsigned int getId () const
std::vector< std::string > getJointNamesInGoal ()
 Returns a vector of joint messages corresponding to all the joints in the goal constraints of the underlying motion plan request message.
tf::Transform getLastGoodGoalPose () const
 Returns the last goal pose that had a good IK solution.
tf::Transform getLastGoodStartPose () const
 Returns the last starting pose that had a good IK solution.
arm_navigation_msgs::MotionPlanRequestgetMotionPlanRequest ()
 Gets the underlying motion plan request message.
const std::string & getName () const
 Returns the unique Id of the motion plan request.
unsigned int getNextTrajectoryId () const
double getPitchTolerance () const
unsigned int getPlanningSceneId () const
std::string getPlanningSceneName () const
 Returns the unique planning scene Id that this motion plan request is associated with.
RenderType getRenderType () const
 Gets what mesh to display in RVIZ.
double getRollTolerance () const
const std::string & getSource () const
 Returns the pipeline stage associated with this motion plan request.
const std_msgs::ColorRGBA & getStartColor () const
 Returns the color of the markers of the start position.
planning_models::KinematicStategetStartState ()
 Returns a KinematicState pointer corresponding to the starting joint state of the robot.
std::set< unsigned int > & getTrajectories ()
 Returns a vector of unique trajectory Ids associated with this motion plan request.
double getYawTolerance () const
bool hasGoodIKSolution (const PositionType &type) const
 Returns true if an IK solution was found for this request, and false otherwise.
bool hasPathConstraints () const
bool hasRefreshedColors () const
 Returns true if the refresh counter has been exhausted, and false otherwise.
bool hasStateChanged () const
 Returns true if the joint values or the color of the motion plan request has changed.
bool hasTrajectoryId (unsigned int id) const
void hide ()
 Sets both the start and end positions to invisible.
void hideCollisions ()
 Convenience shorthand for setCollisionsVisible(false)
void hideGoal ()
 Shorthand for setEndVisible(false)
void hideStart ()
 Shorthand for setStartVisible(false)
bool isEndVisible () const
 Returns true if the goal kinematic state of the robot is being published as a set of markers or false otherwise.
bool isGoalEditable () const
 If true, then a 6DOF control and joint controls will be visible for the goal position of the robot. If false, these controls will not be shown.
bool isJointNameInGoal (std::string joint)
 returns whether or not the specified joint name is part of the goal constraints of the motion plan request.
bool isStartEditable () const
 If true, then a 6DOF control and joint controls will be visible for the start position of the robot. If false, these controls will not be shown.
bool isStartVisible () const
 Returns true if the starting kinematic state of the robot is being published as a set of markers or false otherwise.
 MotionPlanRequestData ()
 MotionPlanRequestData (const planning_models::KinematicState *robot_state)
 MotionPlanRequestData (const unsigned int &id, const std::string &source, const arm_navigation_msgs::MotionPlanRequest &request, const planning_models::KinematicState *robot_state, const std::string &end_effector_link)
void refreshColors ()
 Tell the planning scene editor to stop publishing markers for a while so that the colors of the motion plan request can be changed.
void removeTrajectoryId (unsigned int id)
void reset ()
 Deletes the kinematic states associated with the motion plan request.
void setCollisionsVisible (bool visible)
 Either show or hide the red spheres corresponding to collision points.
void setConstrainPitch (bool s)
void setConstrainRoll (bool s)
void setConstrainYaw (bool s)
void setEndEffectorLink (const std::string &name)
 Sets the name of the link that IK is performed for.
void setEndVisible (bool visible)
 see isEndVisible
void setGoalAndPathPositionOrientationConstraints (arm_navigation_msgs::MotionPlanRequest &mpr, planning_scene_utils::PositionType type) const
void setGoalColor (std_msgs::ColorRGBA color)
 Sets the color of the markers for the goal position.
void setGoalEditable (bool editable)
 If true, then a 6DOF control and joint controls will be visible for the goal position of the robot. If false, these controls will not be shown.
void setGoalState (planning_models::KinematicState *state)
 Sets the kinematic state corresponding to the goal joint state of the robot.
void setGoalStateValues (std::map< std::string, double > &joint_values)
 Sets the goal state joint values of the robot.
void setGroupName (const std::string &name)
 Sets the name of the planning group associated with the motion plan request (usually, right or left arm)
void setHasGoodIKSolution (const bool &solution, const PositionType &type)
 Set whether or not an IK solution was found for the start or end of this request.
void setHasRefreshedColors (bool refresh)
 See hasRefreshedColors.
void setId (const unsigned int id)
 Sets the unique Id of the motion plan request.
void setJointControlsVisible (bool visible, PlanningSceneEditor *editor)
 Either creates or destroys the interactive joint control markers for this request.
void setLastGoodGoalPose (tf::Transform pose)
 Stores a poase as the last goal pose with a good IK solution.
void setLastGoodStartPose (tf::Transform pose)
 Stores a pose as the last starting pose with a good IK solution.
void setMotionPlanRequest (const arm_navigation_msgs::MotionPlanRequest &request)
 Sets the underlying motion plan request message.
void setPathConstraints (bool has)
void setPitchTolerance (double s)
void setPlanningSceneId (const unsigned int id)
 Sets the planning scene Id that this motion plan request is associated with.
void setRenderType (RenderType renderType)
 Sets what mesh to display in RVIZ.
void setRollTolerance (double s)
void setSource (const std::string &source)
 Set the pipeline stage associated with this motion plan request.
void setStartColor (std_msgs::ColorRGBA color)
 Sets the color of the markers for the start position.
void setStartEditable (bool editable)
 If true, then a 6DOF control and joint controls will be visible for the start position of the robot. If false, these controls will not be shown.
void setStartState (planning_models::KinematicState *state)
 Sets the kinematic state corresponding to the starting joint state of the robot.
void setStartStateValues (std::map< std::string, double > &joint_values)
 Sets the start state joint values of the robot.
void setStartVisible (bool visible)
 see isStartVisible
void setStateChanged (bool changed)
 Set the flag recording whether or not the joint state or color of the motion plan request has changed.
void setYawTolerance (double s)
bool shouldRefreshColors () const
 Returns true if the motion plan request's colors have changed, and false otherwise.
void show ()
 Sets both the start and end positions to be published.
void showCollisions ()
 Convenience shorthand for setCollisionsVisible(true)
void showGoal ()
 Shorthand for setEndVisible(true)
void showStart ()
 Shorthand for setStartVisible(true)
void updateCollisionMarkers (planning_environment::CollisionModels *cm_, ros::ServiceClient *distance_state_validity_service_client_)
 Fills the member marker array with small red spheres associated with collision points.
void updateGoalState ()
 Updates the KinematicState pointer goal_state_ to reflect changes to the underlying motion plan request message.
void updateStartState ()
 Updates the KinematicState pointer start_state_ to reflect changes to the underlying motion plan request message.

Public Attributes

ros::Duration refresh_timer_
 If the color of the motion plan request changes, this counter is incremented until it reaches a value specified by the planning scene editor. This is done to allow the display markers time to disappear before their colors are changed.

Protected Attributes

bool are_collisions_visible_
bool are_joint_controls_visible_
visualization_msgs::MarkerArray collision_markers_
bool constrain_pitch_
bool constrain_roll_
bool constrain_yaw_
std::string end_effector_link_
std_msgs::ColorRGBA goal_color_
planning_models::KinematicStategoal_state_
std::string group_name_
bool has_good_goal_ik_solution_
bool has_good_start_ik_solution_
bool has_path_constraints_
bool has_refreshed_colors_
bool has_state_changed_
unsigned int id_
bool is_goal_editable_
bool is_goal_visible_
bool is_start_editable_
bool is_start_visible_
tf::Transform last_good_goal_pose_
tf::Transform last_good_start_pose_
arm_navigation_msgs::MotionPlanRequest motion_plan_request_
std::string name_
unsigned int next_trajectory_id_
double pitch_tolerance_
unsigned int planning_scene_id_
RenderType render_type_
double roll_tolerance_
bool should_refresh_colors_
std::string source_
std_msgs::ColorRGBA start_color_
planning_models::KinematicStatestart_state_
std::set< unsigned int > trajectories_
double yaw_tolerance_

Detailed Description

Convenience class wrapping a motion plan request and its meta-data.

Class MotionPlanRequestData

Definition at line 334 of file move_arm_utils.h.


Constructor & Destructor Documentation

Definition at line 377 of file move_arm_utils.h.

Definition at line 340 of file move_arm_utils.cpp.

planning_scene_utils::MotionPlanRequestData::MotionPlanRequestData ( const unsigned int &  id,
const std::string &  source,
const arm_navigation_msgs::MotionPlanRequest request,
const planning_models::KinematicState robot_state,
const std::string &  end_effector_link 
)

Member Function Documentation

Definition at line 818 of file move_arm_utils.h.

Return whether or not the small red spheres corresponding to collision points are being published.

Definition at line 464 of file move_arm_utils.h.

returns whether the interactive joint control markers are visible.

Definition at line 435 of file move_arm_utils.h.

visualization_msgs::MarkerArray& planning_scene_utils::MotionPlanRequestData::getCollisionMarkers ( ) [inline]

Each motion plan request stores an array of small red spheres corresponding to collision points.

Definition at line 458 of file move_arm_utils.h.

Definition at line 846 of file move_arm_utils.h.

Definition at line 838 of file move_arm_utils.h.

Definition at line 854 of file move_arm_utils.h.

Returns the name of the link that IK is performed for.

Definition at line 581 of file move_arm_utils.h.

const std_msgs::ColorRGBA& planning_scene_utils::MotionPlanRequestData::getGoalColor ( ) const [inline]

Returns the color of the markers of the goal position.

Definition at line 719 of file move_arm_utils.h.

Returns a KinematicState pointer corresponding to the goal joint constraints of the robot.

Definition at line 568 of file move_arm_utils.h.

Returns the name of the planning group associated with the motion plan request (usually, right or left arm)

Definition at line 575 of file move_arm_utils.h.

unsigned int planning_scene_utils::MotionPlanRequestData::getId ( ) const [inline]

Definition at line 605 of file move_arm_utils.h.

std::vector< std::string > MotionPlanRequestData::getJointNamesInGoal ( )

Returns a vector of joint messages corresponding to all the joints in the goal constraints of the underlying motion plan request message.

Definition at line 718 of file move_arm_utils.cpp.

Returns the last goal pose that had a good IK solution.

Definition at line 494 of file move_arm_utils.h.

Returns the last starting pose that had a good IK solution.

Definition at line 488 of file move_arm_utils.h.

Gets the underlying motion plan request message.

Definition at line 777 of file move_arm_utils.h.

const std::string& planning_scene_utils::MotionPlanRequestData::getName ( void  ) const [inline]

Returns the unique Id of the motion plan request.

Definition at line 600 of file move_arm_utils.h.

Definition at line 813 of file move_arm_utils.h.

Definition at line 870 of file move_arm_utils.h.

Definition at line 796 of file move_arm_utils.h.

Returns the unique planning scene Id that this motion plan request is associated with.

Definition at line 802 of file move_arm_utils.h.

Gets what mesh to display in RVIZ.

Definition at line 423 of file move_arm_utils.h.

Definition at line 862 of file move_arm_utils.h.

const std::string& planning_scene_utils::MotionPlanRequestData::getSource ( ) const [inline]

Returns the pipeline stage associated with this motion plan request.

Definition at line 771 of file move_arm_utils.h.

const std_msgs::ColorRGBA& planning_scene_utils::MotionPlanRequestData::getStartColor ( ) const [inline]

Returns the color of the markers of the start position.

Definition at line 713 of file move_arm_utils.h.

Returns a KinematicState pointer corresponding to the starting joint state of the robot.

Definition at line 562 of file move_arm_utils.h.

Returns a vector of unique trajectory Ids associated with this motion plan request.

Definition at line 808 of file move_arm_utils.h.

Definition at line 878 of file move_arm_utils.h.

Returns true if an IK solution was found for this request, and false otherwise.

Definition at line 542 of file move_arm_utils.h.

Definition at line 830 of file move_arm_utils.h.

Returns true if the refresh counter has been exhausted, and false otherwise.

Definition at line 623 of file move_arm_utils.h.

Returns true if the joint values or the color of the motion plan request has changed.

Definition at line 446 of file move_arm_utils.h.

Definition at line 826 of file move_arm_utils.h.

Sets both the start and end positions to invisible.

Definition at line 682 of file move_arm_utils.h.

Convenience shorthand for setCollisionsVisible(false)

Definition at line 482 of file move_arm_utils.h.

Shorthand for setEndVisible(false)

Definition at line 707 of file move_arm_utils.h.

Shorthand for setStartVisible(false)

Definition at line 701 of file move_arm_utils.h.

Returns true if the goal kinematic state of the robot is being published as a set of markers or false otherwise.

Definition at line 657 of file move_arm_utils.h.

If true, then a 6DOF control and joint controls will be visible for the goal position of the robot. If false, these controls will not be shown.

Definition at line 759 of file move_arm_utils.h.

returns whether or not the specified joint name is part of the goal constraints of the motion plan request.

Parameters:
jointa valid joint name.
Returns:
true if the joint with the specified name is in the goal constraints, and false otherwise

Definition at line 733 of file move_arm_utils.cpp.

If true, then a 6DOF control and joint controls will be visible for the start position of the robot. If false, these controls will not be shown.

Definition at line 752 of file move_arm_utils.h.

Returns true if the starting kinematic state of the robot is being published as a set of markers or false otherwise.

Definition at line 650 of file move_arm_utils.h.

Tell the planning scene editor to stop publishing markers for a while so that the colors of the motion plan request can be changed.

Definition at line 641 of file move_arm_utils.h.

Definition at line 822 of file move_arm_utils.h.

Deletes the kinematic states associated with the motion plan request.

Definition at line 526 of file move_arm_utils.h.

Either show or hide the red spheres corresponding to collision points.

Definition at line 470 of file move_arm_utils.h.

Definition at line 850 of file move_arm_utils.h.

Definition at line 842 of file move_arm_utils.h.

Definition at line 858 of file move_arm_utils.h.

void planning_scene_utils::MotionPlanRequestData::setEndEffectorLink ( const std::string &  name) [inline]

Sets the name of the link that IK is performed for.

Definition at line 594 of file move_arm_utils.h.

see isEndVisible

Definition at line 669 of file move_arm_utils.h.

Definition at line 565 of file move_arm_utils.cpp.

void planning_scene_utils::MotionPlanRequestData::setGoalColor ( std_msgs::ColorRGBA  color) [inline]

Sets the color of the markers for the goal position.

Definition at line 731 of file move_arm_utils.h.

If true, then a 6DOF control and joint controls will be visible for the goal position of the robot. If false, these controls will not be shown.

Definition at line 745 of file move_arm_utils.h.

Sets the kinematic state corresponding to the goal joint state of the robot.

Definition at line 519 of file move_arm_utils.h.

void MotionPlanRequestData::setGoalStateValues ( std::map< std::string, double > &  joint_values)

Sets the goal state joint values of the robot.

Parameters:
joint_valuesa map of joint names to values.

Definition at line 529 of file move_arm_utils.cpp.

void planning_scene_utils::MotionPlanRequestData::setGroupName ( const std::string &  name) [inline]

Sets the name of the planning group associated with the motion plan request (usually, right or left arm)

Definition at line 588 of file move_arm_utils.h.

void planning_scene_utils::MotionPlanRequestData::setHasGoodIKSolution ( const bool solution,
const PositionType type 
) [inline]

Set whether or not an IK solution was found for the start or end of this request.

Definition at line 552 of file move_arm_utils.h.

See hasRefreshedColors.

Definition at line 629 of file move_arm_utils.h.

void planning_scene_utils::MotionPlanRequestData::setId ( const unsigned int  id) [inline]

Sets the unique Id of the motion plan request.

Definition at line 610 of file move_arm_utils.h.

Either creates or destroys the interactive joint control markers for this request.

Parameters:
visibleif true, creates the joint markers. If False, destroys them.
editorpointer to the planning scene editor responsible for maintaining the markers.

Definition at line 493 of file move_arm_utils.cpp.

Stores a poase as the last goal pose with a good IK solution.

Definition at line 506 of file move_arm_utils.h.

Stores a pose as the last starting pose with a good IK solution.

Definition at line 500 of file move_arm_utils.h.

Sets the underlying motion plan request message.

Definition at line 783 of file move_arm_utils.h.

Definition at line 834 of file move_arm_utils.h.

Definition at line 874 of file move_arm_utils.h.

void planning_scene_utils::MotionPlanRequestData::setPlanningSceneId ( const unsigned int  id) [inline]

Sets the planning scene Id that this motion plan request is associated with.

Definition at line 792 of file move_arm_utils.h.

Sets what mesh to display in RVIZ.

Definition at line 429 of file move_arm_utils.h.

Definition at line 866 of file move_arm_utils.h.

void planning_scene_utils::MotionPlanRequestData::setSource ( const std::string &  source) [inline]

Set the pipeline stage associated with this motion plan request.

Definition at line 765 of file move_arm_utils.h.

void planning_scene_utils::MotionPlanRequestData::setStartColor ( std_msgs::ColorRGBA  color) [inline]

Sets the color of the markers for the start position.

Definition at line 725 of file move_arm_utils.h.

If true, then a 6DOF control and joint controls will be visible for the start position of the robot. If false, these controls will not be shown.

Definition at line 738 of file move_arm_utils.h.

Sets the kinematic state corresponding to the starting joint state of the robot.

Definition at line 512 of file move_arm_utils.h.

void MotionPlanRequestData::setStartStateValues ( std::map< std::string, double > &  joint_values)

Sets the start state joint values of the robot.

Parameters:
joint_valuesa map of joint names to values.

Definition at line 523 of file move_arm_utils.cpp.

see isStartVisible

Definition at line 663 of file move_arm_utils.h.

Set the flag recording whether or not the joint state or color of the motion plan request has changed.

Definition at line 452 of file move_arm_utils.h.

Definition at line 882 of file move_arm_utils.h.

Returns true if the motion plan request's colors have changed, and false otherwise.

Definition at line 617 of file move_arm_utils.h.

Sets both the start and end positions to be published.

Definition at line 675 of file move_arm_utils.h.

Convenience shorthand for setCollisionsVisible(true)

Definition at line 476 of file move_arm_utils.h.

Shorthand for setEndVisible(true)

Definition at line 695 of file move_arm_utils.h.

Shorthand for setStartVisible(true)

Definition at line 689 of file move_arm_utils.h.

void MotionPlanRequestData::updateCollisionMarkers ( planning_environment::CollisionModels cm_,
ros::ServiceClient distance_state_validity_service_client_ 
)

Fills the member marker array with small red spheres associated with collision points.

Definition at line 633 of file move_arm_utils.cpp.

Updates the KinematicState pointer goal_state_ to reflect changes to the underlying motion plan request message.

Definition at line 452 of file move_arm_utils.cpp.

Updates the KinematicState pointer start_state_ to reflect changes to the underlying motion plan request message.

Definition at line 488 of file move_arm_utils.cpp.


Member Data Documentation

Definition at line 353 of file move_arm_utils.h.

Definition at line 355 of file move_arm_utils.h.

visualization_msgs::MarkerArray planning_scene_utils::MotionPlanRequestData::collision_markers_ [protected]

Definition at line 372 of file move_arm_utils.h.

Definition at line 362 of file move_arm_utils.h.

Definition at line 361 of file move_arm_utils.h.

Definition at line 363 of file move_arm_utils.h.

Definition at line 341 of file move_arm_utils.h.

Definition at line 366 of file move_arm_utils.h.

Definition at line 369 of file move_arm_utils.h.

Definition at line 342 of file move_arm_utils.h.

Definition at line 351 of file move_arm_utils.h.

Definition at line 352 of file move_arm_utils.h.

Definition at line 350 of file move_arm_utils.h.

Definition at line 349 of file move_arm_utils.h.

Definition at line 354 of file move_arm_utils.h.

Definition at line 338 of file move_arm_utils.h.

Definition at line 345 of file move_arm_utils.h.

Definition at line 347 of file move_arm_utils.h.

Definition at line 344 of file move_arm_utils.h.

Definition at line 346 of file move_arm_utils.h.

Definition at line 371 of file move_arm_utils.h.

Definition at line 370 of file move_arm_utils.h.

Definition at line 343 of file move_arm_utils.h.

Definition at line 337 of file move_arm_utils.h.

Definition at line 374 of file move_arm_utils.h.

Definition at line 358 of file move_arm_utils.h.

Definition at line 340 of file move_arm_utils.h.

If the color of the motion plan request changes, this counter is incremented until it reaches a value specified by the planning scene editor. This is done to allow the display markers time to disappear before their colors are changed.

Definition at line 393 of file move_arm_utils.h.

Definition at line 373 of file move_arm_utils.h.

Definition at line 357 of file move_arm_utils.h.

Definition at line 348 of file move_arm_utils.h.

Definition at line 339 of file move_arm_utils.h.

Definition at line 365 of file move_arm_utils.h.

Definition at line 368 of file move_arm_utils.h.

Definition at line 367 of file move_arm_utils.h.

Definition at line 359 of file move_arm_utils.h.


The documentation for this class was generated from the following files:


srs_assisted_arm_navigation
Author(s): Zdenek Materna (imaterna@fit.vutbr.cz), Michal Spanel (spanel@fit.vutbr.cz)
autogenerated on Mon Oct 6 2014 08:12:10