本文整理汇总了C++中robot_state::RobotState::getRobotMarkers方法的典型用法代码示例。如果您正苦于以下问题:C++ RobotState::getRobotMarkers方法的具体用法?C++ RobotState::getRobotMarkers怎么用?C++ RobotState::getRobotMarkers使用的例子?那么, 这里精选的方法代码示例或许可以为您提供帮助。您也可以进一步了解该方法所在类robot_state::RobotState
的用法示例。
在下文中一共展示了RobotState::getRobotMarkers方法的1个代码示例,这些例子默认根据受欢迎程度排序。您可以为喜欢或者感觉有用的代码点赞,您的评价将有助于系统推荐出更棒的C++代码示例。
示例1: displayInitialWaypoints
void displayInitialWaypoints(robot_state::RobotState& state,
ros::NodeHandle& node_handle,
robot_model::RobotModelPtr& robot_model,
const std::vector<std::string>& hierarchy,
const std::vector<Eigen::VectorXd>& waypoints)
{
static ros::Publisher vis_marker_array_publisher = node_handle.advertise<visualization_msgs::MarkerArray>("/move_itomp/visualization_marker_array", 10);
visualization_msgs::MarkerArray ma;
std::vector<std::string> link_names = robot_model->getLinkModelNames();
std_msgs::ColorRGBA color;
color.a = 0.5;
color.r = 1.0;
color.g = 1.0;
color.b = 0.0;
//ros::Duration dur(3600.0);
ros::Duration dur(0.25);
for (unsigned int point = 0; point < waypoints.size(); ++point)
{
ma.markers.clear();
setRobotStateFrom(state, hierarchy, waypoints, point);
double time = 0.05;
ros::WallDuration timer(time);
timer.sleep();
std::string ns = "init_" + boost::lexical_cast<std::string>(point);
state.getRobotMarkers(ma, link_names, color, ns, dur);
vis_marker_array_publisher.publish(ma);
}
}