Skip to content

Commit

Permalink
Merge branch 'main' into andyz/servo_realtime_update
Browse files Browse the repository at this point in the history
  • Loading branch information
AndyZe committed Jan 9, 2023
2 parents 1407fda + 165bf03 commit 4bcb403
Show file tree
Hide file tree
Showing 4 changed files with 2 additions and 5 deletions.
1 change: 1 addition & 0 deletions .github/ISSUE_TEMPLATE/bug_report.md
Original file line number Diff line number Diff line change
Expand Up @@ -17,6 +17,7 @@ Overview of your issue here.
* Source or Binary build?
* If binary, which release version?
* If source, which branch?
* Which RMW (Fast DDS or Cyclone DDS)? Humble or Rolling should be using Cyclone.

### Steps to reproduce
Tell us how to reproduce this issue. Attempt to provide a working demo, perhaps using Docker.
Expand Down
3 changes: 1 addition & 2 deletions .github/workflows/ci.yaml
Original file line number Diff line number Diff line change
Expand Up @@ -21,8 +21,7 @@ jobs:
ROS_DISTRO: rolling
- IMAGE: rolling-ci-testing
ROS_DISTRO: rolling
# Disabled: https://github.com/ros-planning/moveit2/issues/1773
# IKFAST_TEST: true
IKFAST_TEST: true
CLANG_TIDY: pedantic
- IMAGE: humble-ci
ROS_DISTRO: humble
Expand Down
Original file line number Diff line number Diff line change
@@ -1,8 +1,6 @@
#! /usr/bin/env python
from __future__ import print_function

from symbol import parameters

"""
IKFast Plugin Generator for MoveIt
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -51,7 +51,6 @@
#include <moveit/common_planning_interface_objects/common_objects.h>
#include <moveit/robot_state/conversions.h>
#include <moveit_msgs/action/execute_trajectory.hpp>
#include <moveit_msgs/srv/execute_known_trajectory.hpp>
#include <moveit_msgs/srv/query_planner_interfaces.hpp>
#include <moveit_msgs/srv/get_cartesian_path.hpp>
#include <moveit_msgs/srv/grasp_planning.hpp>
Expand Down

0 comments on commit 4bcb403

Please sign in to comment.