Public Types | Public Member Functions | Protected Member Functions | Protected Attributes
FootstepMarker Class Reference

#include <footstep_marker.h>

List of all members.

Public Types

typedef
jsk_interactive_marker::FootstepMarkerConfig 
Config
typedef
actionlib::SimpleActionClient
< jsk_footstep_msgs::ExecFootstepsAction > 
ExecuteActionClient
typedef
actionlib::SimpleActionClient
< jsk_footstep_msgs::PlanFootstepsAction > 
PlanningActionClient
typedef
jsk_footstep_msgs::PlanFootstepsResult 
PlanResult

Public Member Functions

 FootstepMarker ()
void updateInitialFootstep ()
virtual ~FootstepMarker ()

Protected Member Functions

void callEstimateOcclusion ()
void cancelWalk ()
void changePlannerHeuristic (const std::string &heuristic)
geometry_msgs::Pose computeLegTransformation (uint8_t leg)
geometry_msgs::Polygon computePolygon (uint8_t leg)
void configCallback (Config &config, uint32_t level)
void executeCB (const std_msgs::Empty::ConstPtr &msg)
void executeFootstep ()
geometry_msgs::Pose getFootstepPose (bool leftp)
void initializeInteractiveMarker ()
void lookGround ()
visualization_msgs::Marker makeFootstepMarker (geometry_msgs::Pose pose)
void menuCommandCB (const std_msgs::UInt8::ConstPtr &msg)
void menuFeedbackCB (const visualization_msgs::InteractiveMarkerFeedbackConstPtr &feedback)
void moveMarkerCB (const geometry_msgs::PoseStamped::ConstPtr &msg)
void planDoneCB (const actionlib::SimpleClientGoalState &state, const PlanResult::ConstPtr &result)
void planIfPossible ()
void processFeedbackCB (const visualization_msgs::InteractiveMarkerFeedbackConstPtr &feedback)
void processMenuFeedback (uint8_t id)
void projectionCallback (const geometry_msgs::PoseStamped &pose)
bool projectMarkerToPlane ()
void readPoseParam (ros::NodeHandle &pnh, const std::string param, tf::Transform &offset)
void resetLegPoses ()
void resumeCB (const std_msgs::Empty::ConstPtr &msg)
void resumeFootstep ()
void snapLegs ()

Protected Attributes

PlanningActionClient ac_
ExecuteActionClient ac_exec_
bool always_planning_
ros::Publisher current_pose_pub_
ros::ServiceClient estimate_occlusion_client_
ros::Subscriber exec_sub_
double foot_size_x_
double foot_size_y_
double foot_size_z_
double footstep_margin_
ros::Publisher footstep_pub_
std::string initial_reference_frame_
jsk_recognition_msgs::SimpleOccupancyGridArray::ConstPtr latest_grids_
std::string lfoot_frame_id_
bool lleg_first_
geometry_msgs::Pose lleg_initial_pose_
tf::Transform lleg_offset_
geometry_msgs::Pose lleg_pose_
std::string marker_frame_id_
geometry_msgs::PoseStamped marker_pose_
ros::Subscriber menu_command_sub_
interactive_markers::MenuHandler menu_handler_
ros::Subscriber move_marker_sub_
PlanResult::ConstPtr plan_result_
bool plan_run_
boost::mutex plan_run_mutex_
boost::mutex plane_mutex_
ros::Publisher project_footprint_pub_
ros::Subscriber projection_sub_
ros::Subscriber resume_sub_
std::string rfoot_frame_id_
geometry_msgs::Pose rleg_initial_pose_
tf::Transform rleg_offset_
geometry_msgs::Pose rleg_pose_
boost::shared_ptr
< interactive_markers::InteractiveMarkerServer
server_
bool show_6dof_control_
ros::ServiceClient snapit_client_
ros::Publisher snapped_pose_pub_
boost::shared_ptr
< dynamic_reconfigure::Server
< Config > > 
srv_
boost::shared_ptr
< tf::TransformListener
tf_listener_
bool use_footstep_controller_
bool use_footstep_planner_
bool use_initial_footstep_tf_
bool use_initial_reference_
bool use_plane_snap_
bool use_projection_service_
bool use_projection_topic_
bool wait_snapit_server_

Detailed Description

Definition at line 63 of file footstep_marker.h.


Member Typedef Documentation

typedef jsk_interactive_marker::FootstepMarkerConfig FootstepMarker::Config

Definition at line 65 of file footstep_marker.h.

typedef actionlib::SimpleActionClient<jsk_footstep_msgs::ExecFootstepsAction> FootstepMarker::ExecuteActionClient

Definition at line 72 of file footstep_marker.h.

typedef actionlib::SimpleActionClient<jsk_footstep_msgs::PlanFootstepsAction> FootstepMarker::PlanningActionClient

Definition at line 70 of file footstep_marker.h.

typedef jsk_footstep_msgs::PlanFootstepsResult FootstepMarker::PlanResult

Definition at line 73 of file footstep_marker.h.


Constructor & Destructor Documentation

Definition at line 57 of file footstep_marker.cpp.

Definition at line 821 of file footstep_marker.cpp.


Member Function Documentation

Definition at line 478 of file footstep_marker.cpp.

void FootstepMarker::cancelWalk ( ) [protected]

Definition at line 471 of file footstep_marker.cpp.

void FootstepMarker::changePlannerHeuristic ( const std::string heuristic) [protected]

Definition at line 459 of file footstep_marker.cpp.

Definition at line 295 of file footstep_marker.cpp.

geometry_msgs::Polygon FootstepMarker::computePolygon ( uint8_t  leg) [protected]

Definition at line 332 of file footstep_marker.cpp.

void FootstepMarker::configCallback ( Config config,
uint32_t  level 
) [protected]

Definition at line 223 of file footstep_marker.cpp.

void FootstepMarker::executeCB ( const std_msgs::Empty::ConstPtr &  msg) [protected]

Definition at line 365 of file footstep_marker.cpp.

void FootstepMarker::executeFootstep ( ) [protected]

Definition at line 591 of file footstep_marker.cpp.

Definition at line 684 of file footstep_marker.cpp.

Definition at line 751 of file footstep_marker.cpp.

void FootstepMarker::lookGround ( ) [protected]

Definition at line 403 of file footstep_marker.cpp.

visualization_msgs::Marker FootstepMarker::makeFootstepMarker ( geometry_msgs::Pose  pose) [protected]

Definition at line 740 of file footstep_marker.cpp.

void FootstepMarker::menuCommandCB ( const std_msgs::UInt8::ConstPtr &  msg) [protected]

Definition at line 373 of file footstep_marker.cpp.

void FootstepMarker::menuFeedbackCB ( const visualization_msgs::InteractiveMarkerFeedbackConstPtr &  feedback) [protected]

Definition at line 532 of file footstep_marker.cpp.

void FootstepMarker::moveMarkerCB ( const geometry_msgs::PoseStamped::ConstPtr &  msg) [protected]

Definition at line 716 of file footstep_marker.cpp.

void FootstepMarker::planDoneCB ( const actionlib::SimpleClientGoalState state,
const PlanResult::ConstPtr &  result 
) [protected]

Definition at line 673 of file footstep_marker.cpp.

void FootstepMarker::planIfPossible ( ) [protected]

Definition at line 615 of file footstep_marker.cpp.

void FootstepMarker::processFeedbackCB ( const visualization_msgs::InteractiveMarkerFeedbackConstPtr &  feedback) [protected]

Definition at line 536 of file footstep_marker.cpp.

void FootstepMarker::processMenuFeedback ( uint8_t  id) [protected]

Definition at line 414 of file footstep_marker.cpp.

void FootstepMarker::projectionCallback ( const geometry_msgs::PoseStamped &  pose) [protected]

Definition at line 574 of file footstep_marker.cpp.

Definition at line 484 of file footstep_marker.cpp.

void FootstepMarker::readPoseParam ( ros::NodeHandle pnh,
const std::string  param,
tf::Transform offset 
) [protected]

Definition at line 245 of file footstep_marker.cpp.

void FootstepMarker::resetLegPoses ( ) [protected]

Definition at line 277 of file footstep_marker.cpp.

void FootstepMarker::resumeCB ( const std_msgs::Empty::ConstPtr &  msg) [protected]

Definition at line 369 of file footstep_marker.cpp.

void FootstepMarker::resumeFootstep ( ) [protected]

Definition at line 560 of file footstep_marker.cpp.

void FootstepMarker::snapLegs ( ) [protected]

Definition at line 323 of file footstep_marker.cpp.

Definition at line 377 of file footstep_marker.cpp.


Member Data Documentation

Definition at line 139 of file footstep_marker.h.

Definition at line 140 of file footstep_marker.h.

Definition at line 151 of file footstep_marker.h.

Definition at line 134 of file footstep_marker.h.

Definition at line 137 of file footstep_marker.h.

Definition at line 129 of file footstep_marker.h.

double FootstepMarker::foot_size_x_ [protected]

Definition at line 121 of file footstep_marker.h.

double FootstepMarker::foot_size_y_ [protected]

Definition at line 122 of file footstep_marker.h.

double FootstepMarker::foot_size_z_ [protected]

Definition at line 123 of file footstep_marker.h.

Definition at line 124 of file footstep_marker.h.

Definition at line 135 of file footstep_marker.h.

Definition at line 153 of file footstep_marker.h.

jsk_recognition_msgs::SimpleOccupancyGridArray::ConstPtr FootstepMarker::latest_grids_ [protected]

Definition at line 102 of file footstep_marker.h.

Definition at line 160 of file footstep_marker.h.

bool FootstepMarker::lleg_first_ [protected]

Definition at line 152 of file footstep_marker.h.

Definition at line 156 of file footstep_marker.h.

Definition at line 158 of file footstep_marker.h.

Definition at line 154 of file footstep_marker.h.

Definition at line 125 of file footstep_marker.h.

geometry_msgs::PoseStamped FootstepMarker::marker_pose_ [protected]

Definition at line 126 of file footstep_marker.h.

Definition at line 128 of file footstep_marker.h.

Definition at line 120 of file footstep_marker.h.

Definition at line 127 of file footstep_marker.h.

PlanResult::ConstPtr FootstepMarker::plan_result_ [protected]

Definition at line 164 of file footstep_marker.h.

bool FootstepMarker::plan_run_ [protected]

Definition at line 146 of file footstep_marker.h.

Definition at line 97 of file footstep_marker.h.

Definition at line 96 of file footstep_marker.h.

Definition at line 132 of file footstep_marker.h.

Definition at line 131 of file footstep_marker.h.

Definition at line 130 of file footstep_marker.h.

Definition at line 161 of file footstep_marker.h.

Definition at line 157 of file footstep_marker.h.

Definition at line 159 of file footstep_marker.h.

Definition at line 155 of file footstep_marker.h.

Definition at line 119 of file footstep_marker.h.

Definition at line 143 of file footstep_marker.h.

Definition at line 136 of file footstep_marker.h.

Definition at line 133 of file footstep_marker.h.

boost::shared_ptr<dynamic_reconfigure::Server<Config> > FootstepMarker::srv_ [protected]

Definition at line 98 of file footstep_marker.h.

boost::shared_ptr<tf::TransformListener> FootstepMarker::tf_listener_ [protected]

Definition at line 138 of file footstep_marker.h.

Definition at line 145 of file footstep_marker.h.

Definition at line 144 of file footstep_marker.h.

Definition at line 149 of file footstep_marker.h.

Definition at line 150 of file footstep_marker.h.

Definition at line 147 of file footstep_marker.h.

Definition at line 141 of file footstep_marker.h.

Definition at line 142 of file footstep_marker.h.

Definition at line 148 of file footstep_marker.h.


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


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