Skip to content

Commit

Permalink
Remove '-W*' options from cmake files (#2903)
Browse files Browse the repository at this point in the history
  • Loading branch information
LeroyR committed Oct 19, 2021
1 parent 38b3010 commit a0ee202
Show file tree
Hide file tree
Showing 4 changed files with 4 additions and 10 deletions.
3 changes: 0 additions & 3 deletions moveit_planners/pilz_industrial_motion_planner/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -3,9 +3,6 @@ project(pilz_industrial_motion_planner)

## Add support for C++14, supported in ROS Melodic and newer
add_definitions(-std=c++14)
add_definitions(-Wall)
add_definitions(-Wextra)
add_definitions(-Wno-unused-parameter)

find_package(catkin REQUIRED COMPONENTS
joint_limits_interface
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -257,7 +257,7 @@ void TrajectoryGeneratorPTP::extractMotionPlanInfo(const planning_scene::Plannin
}
}

void TrajectoryGeneratorPTP::plan(const planning_scene::PlanningSceneConstPtr& scene,
void TrajectoryGeneratorPTP::plan(const planning_scene::PlanningSceneConstPtr& /*scene*/,
const planning_interface::MotionPlanRequest& req, const MotionPlanInfo& plan_info,
const double& sampling_time, trajectory_msgs::JointTrajectory& joint_trajectory)
{
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -219,7 +219,7 @@ bool testutils::checkCartesianLinearity(const moveit::core::RobotModelConstPtr&
const trajectory_msgs::JointTrajectory& trajectory,
const planning_interface::MotionPlanRequest& req,
const double translation_norm_tolerance, const double rot_axis_norm_tolerance,
const double rot_angle_tolerance)
const double /*rot_angle_tolerance*/)
{
std::string link_name;
Eigen::Isometry3d goal_pose_expect;
Expand Down Expand Up @@ -1102,7 +1102,8 @@ bool testutils::checkBlendResult(const pilz_industrial_motion_planner::Trajector
const pilz_industrial_motion_planner::TrajectoryBlendResponse& blend_res,
const pilz_industrial_motion_planner::LimitsContainer& limits,
double joint_velocity_tolerance, double joint_acceleration_tolerance,
double cartesian_velocity_tolerance, double cartesian_angular_velocity_tolerance)
double /*cartesian_velocity_tolerance*/,
double /*cartesian_angular_velocity_tolerance*/)
{
// ++++++++++++++++++++++
// + Check trajectories +
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -3,10 +3,6 @@ project(pilz_industrial_motion_planner_testutils)

## Add support for C++11, supported in ROS Kinetic and newer
add_definitions(-std=c++11)
add_definitions(-Wall)
add_definitions(-Wextra)
add_definitions(-Wno-unused-parameter)
add_definitions(-Werror)

find_package(catkin REQUIRED COMPONENTS
tf2_eigen
Expand Down

0 comments on commit a0ee202

Please sign in to comment.