25 int main(
int argc,
char **argv)
31 auto fetch = std::make_shared<FetchRobot>();
40 RBX_INFO(
"RViz Initialized! Press enter to continue (after your RViz is setup)...");
45 scene->fromYAMLFile(
"package://robowflex_library/yaml/test_fetch.yml");
51 auto planner = std::make_shared<OMPL::FetchOMPLPipelinePlanner>(
fetch,
"default");
52 planner->initialize();
56 fetch->setGroupState(
GROUP, {0.05, 1.32, 1.40, -0.2, 1.72, 0.0, 1.66, 0.0});
61 pose.translate(Eigen::Vector3d{0.4, 0.6, 0.92});
63 Eigen::Quaterniond orn{0.5, -0.5, 0.5, 0.5};
76 RBX_INFO(
"Scene and Goal displayed! Press enter to plan...");
81 if (res.
error_code_.val != moveit_msgs::MoveItErrorCodes::SUCCESS)
93 RBX_INFO(
"Press enter to remove goal and scene.");
static GeometryPtr makeSphere(double radius)
Create a sphere.
RVIZ visualization helper. See Live Visualization with RViz for more information.
void removeMarker(const std::string &name)
Removes a marker that was added through addMarker().
void updateMarkers()
Displays the managed list of markers. Keeps track of whether markers have already been displayed and ...
void removeScene()
Removes the scene being visualized.
void updateScene(const SceneConstPtr &scene)
Updates the scene being visualized.
void addGoalMarker(const std::string &name, const MotionRequestBuilder &request)
Adds the current goal of the motion request builder as a set of markers in the marker array.
void updateTrajectory(const planning_interface::MotionPlanResponse &response)
Updates the trajectory being visualized.
Helper class to broadcast transform information on TF and joint states.
void start()
Begin publishing TF and joint information.
A helper class to build motion planning requests for a robowflex::Planner.
void setStartConfiguration(const std::vector< double > &joints)
Set the start configuration from a vector joints. All joints are assumed to be specified and in the d...
planning_interface::MotionPlanRequest & getRequest()
Get a reference to the currently built motion planning request.
void setGoalRegion(const std::string &ee_name, const std::string &base_name, const RobotPose &pose, const GeometryConstPtr &geometry, const Eigen::Quaterniond &orientation, const Eigen::Vector3d &tolerances)
Set a goal region for an end-effector ee_name. Sets the position constraint from geometry at a pose p...
RAII-pattern for starting up ROS.
int main(int argc, char **argv)
static const std::string GROUP
#define RBX_INFO(fmt,...)
Output a info logging message.
Main namespace. Contains all library classes and functions.
std::decay< decltype(std::declval< moveit::core::Transforms >().getTransform("")) >::type RobotPose
A pose (point in SE(3)) used in various functions. Defined from what MoveIt! uses.
Functions for loading and animating scenes in Blender.
moveit_msgs::MoveItErrorCodes error_code_
robot_trajectory::RobotTrajectoryPtr trajectory_
robot_trajectory::RobotTrajectory trajectory(rmodel,"right_arm")