Skip to content

Commit

Permalink
Cosmetic fixes
Browse files Browse the repository at this point in the history
  • Loading branch information
rhaschke committed Mar 9, 2024
1 parent 795bde7 commit 55c4b52
Show file tree
Hide file tree
Showing 4 changed files with 8 additions and 10 deletions.
10 changes: 5 additions & 5 deletions core/include/moveit/task_constructor/solvers/cartesian_path.h
Original file line number Diff line number Diff line change
Expand Up @@ -64,13 +64,13 @@ class CartesianPath : public PlannerInterface
void init(const moveit::core::RobotModelConstPtr& robot_model) override;

Result plan(const planning_scene::PlanningSceneConstPtr& from, const planning_scene::PlanningSceneConstPtr& to,
const moveit::core::JointModelGroup* jmg, double timeout, robot_trajectory::RobotTrajectoryPtr& result,
const moveit_msgs::Constraints& path_constraints = moveit_msgs::Constraints()) override;
const moveit::core::JointModelGroup* jmg, double timeout, robot_trajectory::RobotTrajectoryPtr& result,
const moveit_msgs::Constraints& path_constraints = moveit_msgs::Constraints()) override;

Result plan(const planning_scene::PlanningSceneConstPtr& from, const moveit::core::LinkModel& link,
const Eigen::Isometry3d& offset, const Eigen::Isometry3d& target, const moveit::core::JointModelGroup* jmg,
double timeout, robot_trajectory::RobotTrajectoryPtr& result,
const moveit_msgs::Constraints& path_constraints = moveit_msgs::Constraints()) override;
const Eigen::Isometry3d& offset, const Eigen::Isometry3d& target, const moveit::core::JointModelGroup* jmg,
double timeout, robot_trajectory::RobotTrajectoryPtr& result,
const moveit_msgs::Constraints& path_constraints = moveit_msgs::Constraints()) override;
};
} // namespace solvers
} // namespace task_constructor
Expand Down
4 changes: 2 additions & 2 deletions core/src/stages/generate_random_pose.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -90,7 +90,7 @@ void GenerateRandomPose::compute() {

const SolutionBase& s = *upstream_solutions_.pop();
planning_scene::PlanningScenePtr scene = s.end()->scene()->diff();
geometry_msgs::PoseStamped seed_pose = properties().get<geometry_msgs::PoseStamped>("pose");
auto seed_pose = properties().get<geometry_msgs::PoseStamped>("pose");
if (seed_pose.header.frame_id.empty())
seed_pose.header.frame_id = scene->getPlanningFrame();
else if (!scene->knowsFrameTransform(seed_pose.header.frame_id)) {
Expand All @@ -116,7 +116,7 @@ void GenerateRandomPose::compute() {
if (pose_dimension_samplers_.empty())
return;

geometry_msgs::PoseStamped sample_pose = seed_pose;
auto sample_pose = seed_pose;
Eigen::Isometry3d seed, sample;
tf2::fromMsg(seed_pose.pose, seed);
double elapsed_time = 0.0;
Expand Down
2 changes: 1 addition & 1 deletion core/test/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -38,7 +38,7 @@ if (CATKIN_ENABLE_TESTING)
mtc_add_gtest(test_stage.cpp)
mtc_add_gtest(test_container.cpp)
mtc_add_gmock(test_serial.cpp)
mtc_add_gtest(test_pruning.cpp)
mtc_add_gmock(test_pruning.cpp)
mtc_add_gtest(test_properties.cpp)
mtc_add_gtest(test_cost_terms.cpp)

Expand Down
2 changes: 0 additions & 2 deletions core/test/stage_mockups.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -3,8 +3,6 @@

#include "stage_mockups.h"

#include <gtest/gtest.h>

namespace moveit {
namespace task_constructor {

Expand Down

0 comments on commit 55c4b52

Please sign in to comment.