Skip to content

Commit

Permalink
Ran clang formatting
Browse files Browse the repository at this point in the history
  • Loading branch information
DavidSpielman authored and marip8 committed May 29, 2024
1 parent 87c066f commit e4ca4c0
Show file tree
Hide file tree
Showing 3 changed files with 14 additions and 11 deletions.
3 changes: 2 additions & 1 deletion snp_application/src/bt/snp_bt_ros_nodes.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -64,7 +64,8 @@ BT::NodeStatus GenerateMotionPlanServiceNode::onResponseReceived(const typename
return BT::NodeStatus::SUCCESS;
}

sensor_msgs::msg::JointState jointTrajectoryPointToJointState(trajectory_msgs::msg::JointTrajectory jt, trajectory_msgs::msg::JointTrajectoryPoint jtp)
sensor_msgs::msg::JointState jointTrajectoryPointToJointState(trajectory_msgs::msg::JointTrajectory jt,
trajectory_msgs::msg::JointTrajectoryPoint jtp)
{
sensor_msgs::msg::JointState js;
js.name = jt.joint_names;
Expand Down
14 changes: 7 additions & 7 deletions snp_motion_planning/src/planning_server.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -234,7 +234,6 @@ class PlanningServer
node_->declare_parameter(RASTER_TASK_NAME_PARAM, "");
node_->declare_parameter(FREESPACE_TASK_NAME_PARAM, "");


{
auto urdf_string = get<std::string>(node_, "robot_description");
auto srdf_string = get<std::string>(node_, "robot_description_semantic");
Expand All @@ -257,7 +256,8 @@ class PlanningServer
raster_server_ = node_->create_service<snp_msgs::srv::GenerateMotionPlan>(
PLANNING_SERVICE, std::bind(&PlanningServer::planCallback, this, std::placeholders::_1, std::placeholders::_2));
freespace_server_ = node_->create_service<snp_msgs::srv::GenerateFreespaceMotionPlan>(
FREESPACE_PLANNING_SERVICE, std::bind(&PlanningServer::freespaceMotionPlanCallback, this, std::placeholders::_1, std::placeholders::_2));
FREESPACE_PLANNING_SERVICE,
std::bind(&PlanningServer::freespaceMotionPlanCallback, this, std::placeholders::_1, std::placeholders::_2));
remove_scan_link_server_ = node_->create_service<std_srvs::srv::Empty>(
REMOVE_SCAN_LINK_SERVICE,
std::bind(&PlanningServer::removeScanLinkCallback, this, std::placeholders::_1, std::placeholders::_2));
Expand Down Expand Up @@ -621,7 +621,7 @@ class PlanningServer
RCLCPP_INFO_STREAM(node_->get_logger(), res->message);
}
void freespaceMotionPlanCallback(const snp_msgs::srv::GenerateFreespaceMotionPlan::Request::SharedPtr req,
snp_msgs::srv::GenerateFreespaceMotionPlan::Response::SharedPtr res)
snp_msgs::srv::GenerateFreespaceMotionPlan::Response::SharedPtr res)
{
try
{
Expand All @@ -632,20 +632,20 @@ class PlanningServer
manip_info.tcp_frame = req->tcp_frame;
manip_info.working_frame = req->mesh_frame;

tesseract_planning::CompositeInstruction freespace_program(PROFILE, tesseract_planning::CompositeInstructionOrder::ORDERED,
manip_info);
tesseract_planning::CompositeInstruction freespace_program(
PROFILE, tesseract_planning::CompositeInstructionOrder::ORDERED, manip_info);

tesseract_planning::JointWaypoint wp1 = rosJointStateToJointWaypoint(req->js1);
tesseract_planning::JointWaypoint wp2 = rosJointStateToJointWaypoint(req->js2);

// Define a freespace move to the first waypoint
freespace_program.appendMoveInstruction(
tesseract_planning::MoveInstruction(tesseract_planning::JointWaypointPoly{wp1},
tesseract_planning::MoveInstruction(tesseract_planning::JointWaypointPoly{ wp1 },
tesseract_planning::MoveInstructionType::FREESPACE, PROFILE, manip_info));

// Define a freespace move to the second waypoint
freespace_program.appendMoveInstruction(
tesseract_planning::MoveInstruction(tesseract_planning::JointWaypointPoly{wp2},
tesseract_planning::MoveInstruction(tesseract_planning::JointWaypointPoly{ wp2 },
tesseract_planning::MoveInstructionType::FREESPACE, PROFILE, manip_info));

// Add the scan link to the planning environment
Expand Down
8 changes: 5 additions & 3 deletions snp_msgs/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -21,7 +21,6 @@ find_package(rosidl_default_generators REQUIRED)
find_package(trajectory_msgs REQUIRED)
find_package(sensor_msgs REQUIRED)


rosidl_generate_interfaces(
${PROJECT_NAME}
"msg/ToolPath.msg"
Expand All @@ -35,12 +34,15 @@ rosidl_generate_interfaces(
trajectory_msgs
sensor_msgs)


if(BUILD_TESTING)
find_package(ament_lint_auto REQUIRED)
ament_lint_auto_find_test_dependencies()
endif()

# Ament package settings
ament_export_dependencies(geometry_msgs rosidl_default_runtime trajectory_msgs sensor_msgs)
ament_export_dependencies(
geometry_msgs
rosidl_default_runtime
trajectory_msgs
sensor_msgs)
ament_package()

0 comments on commit e4ca4c0

Please sign in to comment.