Enumerations | Functions
im_helpers Namespace Reference

Enumerations

enum  PoseState { UNTESTED, VALID, INVALID }

Functions

void add6DofControl (visualization_msgs::InteractiveMarker &msg, bool fixed=false)
void addVisible6DofControl (visualization_msgs::InteractiveMarker &msg, bool fixed=false, bool visible=true)
geometry_msgs::Pose createPoseMsg (const tf::Transform &transform)
visualization_msgs::InteractiveMarker make6DofMarker (const char *name, const geometry_msgs::PoseStamped &stamped, float scale, bool fixed, bool view_facing)
visualization_msgs::InteractiveMarker makeBaseMarker (const char *name, const geometry_msgs::PoseStamped &stamped, float scale, bool fixed)
visualization_msgs::Marker makeBox (float scale)
visualization_msgs::InteractiveMarkerControl & makeBoxControl (visualization_msgs::InteractiveMarker &msg)
visualization_msgs::InteractiveMarker makeButtonBox (const char *name, const geometry_msgs::PoseStamped &stamped, float scale, bool fixed, bool view_facing)
visualization_msgs::InteractiveMarker makeButtonSphere (const char *name, const geometry_msgs::PoseStamped &stamped, float scale, bool fixed, bool view_facing)
visualization_msgs::InteractiveMarker makeButtonSphere (const char *name, const geometry_msgs::PoseStamped &stamped, float scale, bool fixed, bool view_facing, std_msgs::ColorRGBA color)
visualization_msgs::InteractiveMarker makeElevatorMarker (const char *name, const geometry_msgs::PoseStamped &stamped, float scale, bool fixed)
visualization_msgs::InteractiveMarker makeEmptyMarker (const char *frame_id="")
visualization_msgs::InteractiveMarker makeFollowerMultiMeshMarker (const char *name, const geometry_msgs::PoseStamped &stamped, const std::vector< std::string > &mesh_frames, const std::vector< std::string > &mesh_paths, const float &scale)
visualization_msgs::InteractiveMarker makeGraspMarker (const char *name, const geometry_msgs::PoseStamped &stamped, float scale, PoseState pose_state)
visualization_msgs::InteractiveMarker makeGripperMarker (const char *name, const geometry_msgs::PoseStamped &stamped, float scale, float angle, bool view_facing)
visualization_msgs::InteractiveMarker makeGripperMarker (const char *name, const geometry_msgs::PoseStamped &stamped, float scale, float angle, bool view_facing, std_msgs::ColorRGBA color)
visualization_msgs::InteractiveMarker makeGripperMarker (const char *name, const geometry_msgs::PoseStamped &stamped, float scale, float angle, bool view_facing, std_msgs::ColorRGBA color, bool use_color)
visualization_msgs::InteractiveMarker makeHeadGoalMarker (const char *name, const geometry_msgs::PoseStamped &stamped, float scale)
visualization_msgs::InteractiveMarker makeListControl (const char *name, const geometry_msgs::PoseStamped &stamped, int num, int total, float scale)
visualization_msgs::MenuEntry makeMenuEntry (const char *title)
visualization_msgs::MenuEntry makeMenuEntry (const char *title, const char *command, int type)
visualization_msgs::InteractiveMarker makeMeshMarker (const std::string &name, const std::string &mesh_resource, const geometry_msgs::PoseStamped &stamped, float scale)
visualization_msgs::InteractiveMarker makeMeshMarker (const std::string &name, const std::string &mesh_resource, const geometry_msgs::PoseStamped &stamped, float scale, const std_msgs::ColorRGBA &color)
visualization_msgs::InteractiveMarker makeMeshMarker (const std::string &name, const std::string &mesh_resource, const geometry_msgs::PoseStamped &stamped, float scale, const std_msgs::ColorRGBA &color, bool use_color)
visualization_msgs::InteractiveMarker makePlanarMarker (const char *name, const geometry_msgs::PoseStamped &stamped, float scale, bool fixed)
visualization_msgs::InteractiveMarker makePosedMultiMeshMarker (const char *name, const geometry_msgs::PoseStamped &stamped, const std::vector< geometry_msgs::PoseStamped > &mesh_poses, const std::vector< std::string > &mesh_paths, const float &scale, const bool button_only=true)
visualization_msgs::InteractiveMarker makePostureMarker (const char *name, const geometry_msgs::PoseStamped &stamped, float scale, bool fixed, bool view_facing)
visualization_msgs::InteractiveMarker makeProjectorMarker (const char *name, const geometry_msgs::PoseStamped &stamped, float scale)
visualization_msgs::Marker makeSphere (float scale)
visualization_msgs::InteractiveMarkerControl & makeSphereControl (visualization_msgs::InteractiveMarker &msg)

Enumeration Type Documentation

Enumerator:
UNTESTED 
VALID 
INVALID 

Definition at line 46 of file interactive_marker_helpers.h.


Function Documentation

void im_helpers::add6DofControl ( visualization_msgs::InteractiveMarker &  msg,
bool  fixed = false 
)

Definition at line 96 of file interactive_marker_helpers.cpp.

void im_helpers::addVisible6DofControl ( visualization_msgs::InteractiveMarker &  msg,
bool  fixed = false,
bool  visible = true 
)

Definition at line 131 of file interactive_marker_helpers.cpp.

Definition at line 40 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarker im_helpers::make6DofMarker ( const char *  name,
const geometry_msgs::PoseStamped &  stamped,
float  scale,
bool  fixed,
bool  view_facing 
)

Definition at line 384 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarker im_helpers::makeBaseMarker ( const char *  name,
const geometry_msgs::PoseStamped &  stamped,
float  scale,
bool  fixed 
)

Definition at line 506 of file interactive_marker_helpers.cpp.

visualization_msgs::Marker im_helpers::makeBox ( float  scale)

Definition at line 64 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarkerControl & im_helpers::makeBoxControl ( visualization_msgs::InteractiveMarker &  msg)

Definition at line 170 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarker im_helpers::makeButtonBox ( const char *  name,
const geometry_msgs::PoseStamped &  stamped,
float  scale,
bool  fixed,
bool  view_facing 
)

Definition at line 285 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarker im_helpers::makeButtonSphere ( const char *  name,
const geometry_msgs::PoseStamped &  stamped,
float  scale,
bool  fixed,
bool  view_facing 
)

Definition at line 302 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarker im_helpers::makeButtonSphere ( const char *  name,
const geometry_msgs::PoseStamped &  stamped,
float  scale,
bool  fixed,
bool  view_facing,
std_msgs::ColorRGBA  color 
)

Definition at line 309 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarker im_helpers::makeElevatorMarker ( const char *  name,
const geometry_msgs::PoseStamped &  stamped,
float  scale,
bool  fixed 
)

Definition at line 444 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarker im_helpers::makeEmptyMarker ( const char *  frame_id = "")

Definition at line 55 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarker im_helpers::makeFollowerMultiMeshMarker ( const char *  name,
const geometry_msgs::PoseStamped &  stamped,
const std::vector< std::string > &  mesh_frames,
const std::vector< std::string > &  mesh_paths,
const float &  scale 
)

Definition at line 766 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarker im_helpers::makeGraspMarker ( const char *  name,
const geometry_msgs::PoseStamped &  stamped,
float  scale,
PoseState  pose_state 
)

Definition at line 661 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarker im_helpers::makeGripperMarker ( const char *  name,
const geometry_msgs::PoseStamped &  stamped,
float  scale,
float  angle,
bool  view_facing 
)

Definition at line 584 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarker im_helpers::makeGripperMarker ( const char *  name,
const geometry_msgs::PoseStamped &  stamped,
float  scale,
float  angle,
bool  view_facing,
std_msgs::ColorRGBA  color 
)

Definition at line 591 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarker im_helpers::makeGripperMarker ( const char *  name,
const geometry_msgs::PoseStamped &  stamped,
float  scale,
float  angle,
bool  view_facing,
std_msgs::ColorRGBA  color,
bool  use_color 
)

Definition at line 598 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarker im_helpers::makeHeadGoalMarker ( const char *  name,
const geometry_msgs::PoseStamped &  stamped,
float  scale 
)

Definition at line 224 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarker im_helpers::makeListControl ( const char *  name,
const geometry_msgs::PoseStamped &  stamped,
int  num,
int  total,
float  scale 
)

Definition at line 329 of file interactive_marker_helpers.cpp.

visualization_msgs::MenuEntry im_helpers::makeMenuEntry ( const char *  title)

Definition at line 190 of file interactive_marker_helpers.cpp.

visualization_msgs::MenuEntry im_helpers::makeMenuEntry ( const char *  title,
const char *  command,
int  type 
)

Definition at line 198 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarker im_helpers::makeMeshMarker ( const std::string name,
const std::string mesh_resource,
const geometry_msgs::PoseStamped &  stamped,
float  scale 
)

Definition at line 272 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarker im_helpers::makeMeshMarker ( const std::string name,
const std::string mesh_resource,
const geometry_msgs::PoseStamped &  stamped,
float  scale,
const std_msgs::ColorRGBA &  color 
)

Definition at line 279 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarker im_helpers::makeMeshMarker ( const std::string name,
const std::string mesh_resource,
const geometry_msgs::PoseStamped &  stamped,
float  scale,
const std_msgs::ColorRGBA &  color,
bool  use_color 
)

Definition at line 246 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarker im_helpers::makePlanarMarker ( const char *  name,
const geometry_msgs::PoseStamped &  stamped,
float  scale,
bool  fixed 
)

Definition at line 413 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarker im_helpers::makePosedMultiMeshMarker ( const char *  name,
const geometry_msgs::PoseStamped &  stamped,
const std::vector< geometry_msgs::PoseStamped > &  mesh_poses,
const std::vector< std::string > &  mesh_paths,
const float &  scale,
const bool  button_only = true 
)

Definition at line 716 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarker im_helpers::makePostureMarker ( const char *  name,
const geometry_msgs::PoseStamped &  stamped,
float  scale,
bool  fixed,
bool  view_facing 
)

Definition at line 207 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarker im_helpers::makeProjectorMarker ( const char *  name,
const geometry_msgs::PoseStamped &  stamped,
float  scale 
)

Definition at line 481 of file interactive_marker_helpers.cpp.

visualization_msgs::Marker im_helpers::makeSphere ( float  scale)

Definition at line 80 of file interactive_marker_helpers.cpp.

visualization_msgs::InteractiveMarkerControl & im_helpers::makeSphereControl ( visualization_msgs::InteractiveMarker &  msg)

Definition at line 180 of file interactive_marker_helpers.cpp.



jsk_interactive_marker
Author(s): furuta
autogenerated on Sun Sep 13 2015 22:29:27